Property | Type | Description | |
---|---|---|---|
CONNECT_TIMEOUT_SECONDS | double | ||
MAVlist | MAVList | ||
ReadOnly | bool | ||
Terrain | |||
speechenabled | bool |
Property | Type | Description | |
---|---|---|---|
FrmProgressReporterDoWorkAndParams | void | ||
FrmProgressReporterDoWorkNOParams | void | ||
FrmProgressReporterGetParams | void | ||
OpenBg | void | ||
PacketReceived | void | ||
SetupMavConnect | void | ||
doAction | bool | ||
generatePacket | void | ||
generatePacket | void | ||
generatePacket | void | ||
getDatastream | void | ||
getDatastream | void | ||
getParamListBG | |||
getWPsfromstream | void | ||
hzratecheck | bool | ||
readlogPacketMavlink | MAVLinkMessage |
Method | Description | |
---|---|---|
Close ( ) : void | ||
DebugPacket ( MAVLinkMessage datin ) : object | ||
DebugPacket ( MAVLinkMessage datin, bool PrintToConsole ) : object | ||
DebugPacket ( MAVLinkMessage datin, string &text ) : object | ||
DebugPacket ( MAVLinkMessage datin, string &text, bool PrintToConsole, string delimeter = " " ) : object |
Print entire decoded packet to console
|
|
Dispose ( ) : void | ||
EraseLog ( ) : void | ||
GetLog ( ushort no ) : |
||
GetLogEntry ( ushort startno, ushort endno = ushort.MaxValue ) : mavlink_log_entry_t | ||
GetLogList ( ) : List |
||
GetMountStatus ( ) : void | ||
GetParam ( byte sysid, byte compid, string name = "", short index = -1, bool requireresponce = true ) : float |
Get param by either index or name
|
|
GetParam ( short index ) : float | ||
GetParam ( string name ) : float | ||
GetParam ( string name = "", short index = -1, bool requireresponce = true ) : float | ||
InjectGpsData ( byte data, byte length ) : void | ||
InjectGpsData ( byte sysid, byte compid, byte data, byte length, bool rtcm_message = true ) : void |
used to inject data into the gps ie rtcm/sbp/ubx
|
|
MAVLinkInterface ( ) : System | ||
MAVLinkInterface ( Stream logfileStream ) : System | ||
Open ( ) : void | ||
Open ( bool getparams, bool skipconnectedcheck = false ) : void | ||
SendAck ( ) : void | ||
SendSerialControl ( SERIAL_CONTROL_DEV port, ushort timeoutms, byte data, uint baudrate, bool close = false ) : void | ||
SetSensorOffsets ( sensoroffsetsenum sensor, float x, float y, float z ) : bool | ||
SubscribeToPacketType ( MAVLINK_MSG_ID type, bool>.Func |
||
ToString ( ) : string | ||
UnSubscribeToPacketType ( bool>.KeyValuePair |
||
UnSubscribeToPacketType ( MAVLINK_MSG_ID msgtype, bool>.Func |
||
Write ( string line ) : bool | ||
disableSigning ( int sysid, int compid ) : bool | ||
doARM ( bool armit ) : bool | ||
doARM ( byte sysid, byte compid, bool armit ) : bool | ||
doAbortLand ( ) : bool | ||
doCommand ( MAV_CMD actionid, float p1, float p2, float p3, float p4, float p5, float p6, float p7, bool requireack = true ) : bool | ||
doCommand ( byte sysid, byte compid, MAV_CMD actionid, float p1, float p2, float p3, float p4, float p5, float p6, float p7, bool requireack = true ) : bool | ||
doMotorTest ( int motor, MAVLink thr_type, int throttle, int timeout, int motorcount ) : bool | ||
doReboot ( bool bootloadermode = false, bool currentvehicle = true ) : bool |
reboot the vehicle
|
|
enableSigning ( int sysid, int compid ) : bool | ||
getFencePoint ( int no, int &total ) : MissionPlanner.Utilities.PointLatLngAlt | ||
getHeartBeat ( ) : MAVLinkMessage | ||
getHomePosition ( ) : |
||
getParamList ( ) : void | ||
getParamPoll ( ) : void | ||
getRallyPoint ( int no, int &total ) : MissionPlanner.Utilities.PointLatLngAlt | ||
getRallyPoints ( ) : List |
||
getRequestedWPNo ( ) : int | ||
getVersion ( ) : bool | ||
getWP ( ushort index ) : |
Gets specfied WP
|
|
getWPCount ( ) : ushort |
Returns WP count
|
|
modifyParamForDisplay ( bool fromapm, string paramname, float &value ) : void | ||
readPacket ( ) : MAVLinkMessage |
Serial Reader to read mavlink packets. POLL method
|
|
requestDatastream ( MAVLink id, byte hzrate, int sysid = -1, int compid = -1 ) : void | ||
sendPacket ( object indata, int sysid, int compid ) : void | ||
setAPType ( byte sysid, byte compid ) : void | ||
setAttitudeTarget ( ) : void | ||
setDigicamConfigure ( ) : void | ||
setDigicamControl ( bool shot ) : void | ||
setFencePoint ( byte index, PointLatLngAlt plla, byte fencepointcount ) : bool | ||
setGuidedModeWP ( Locationwp gotohere, bool setguidedmode = true ) : void | ||
setMode ( byte sysid, byte compid, mavlink_set_mode_t mode, MAV_MODE_FLAG base_mode ) : void | ||
setMode ( byte sysid, byte compid, string modein ) : void | ||
setMode ( mavlink_set_mode_t mode, MAV_MODE_FLAG base_mode ) : void | ||
setMode ( string modein ) : void | ||
setMountConfigure ( MAV_MOUNT_MODE mountmode, bool stabroll, bool stabpitch, bool stabyaw ) : void | ||
setMountControl ( double pa, double pb, double pc, bool islatlng ) : void | ||
setNewWPAlt ( Locationwp gotohere ) : void | ||
setNextWPTargetAlt ( ushort wpno, float alt ) : void | ||
setParam ( byte sysid, byte compid, string paramname, double value, bool force = false ) : bool |
Set parameter on apm
|
|
setParam ( string paramnames, double value ) : bool |
set param on apm, used for param rename
|
|
setParam ( string paramname, double value, bool force = false ) : bool | ||
setPositionTargetGlobalInt ( byte sysid, byte compid, bool pos, bool vel, bool acc, MAV_FRAME frame, double lat, double lng, double alt, double vx, double vy, double vz ) : void | ||
setRallyPoint ( byte index, PointLatLngAlt plla, short break_alt, UInt16 land_dir_cd, byte flags, byte rallypointcount ) : bool | ||
setWP ( Locationwp loc, ushort index, MAV_FRAME frame, byte current, byte autocontinue = 1, bool use_int = false ) : MAV_MISSION_RESULT |
Save wp to eeprom
|
|
setWP ( mavlink_mission_item_int_t req ) : MAV_MISSION_RESULT | ||
setWP ( mavlink_mission_item_t req ) : MAV_MISSION_RESULT | ||
setWPACK ( ) : void | ||
setWPCurrent ( ushort index ) : bool | ||
setWPPartialUpdate ( ushort startwp, ushort endwp ) : void |
Set start and finish for partial wp upload.
|
|
setWPTotal ( ushort wp_total ) : void |
Sets wp total count
|
|
setupSigning ( string userseed, byte key = null ) : bool | ||
stopall ( bool forget ) : void |
Stops all requested data packets.
|
|
translateMode ( byte sysid, byte compid, string modein, MAVLink &mode ) : bool | ||
translateMode ( string modein, MAVLink &mode ) : bool |
Method | Description | |
---|---|---|
FrmProgressReporterDoWorkAndParams ( object sender, MissionPlanner.Controls.ProgressWorkerEventArgs e, object passdata = null ) : void | ||
FrmProgressReporterDoWorkNOParams ( object sender, MissionPlanner.Controls.ProgressWorkerEventArgs e, object passdata = null ) : void | ||
FrmProgressReporterGetParams ( object sender, MissionPlanner.Controls.ProgressWorkerEventArgs e, object passdata = null ) : void | ||
OpenBg ( object PRsender, bool getparams, MissionPlanner.Controls.ProgressWorkerEventArgs progressWorkerEventArgs ) : void | ||
PacketReceived ( MAVLinkMessage buffer ) : void | ||
SetupMavConnect ( MAVLinkMessage message, mavlink_heartbeat_t hb ) : void | ||
doAction ( object actionid ) : bool | ||
generatePacket ( MAVLINK_MSG_ID messageType, object indata ) : void | ||
generatePacket ( int messageType, object indata ) : void | ||
generatePacket ( int messageType, object indata, int sysid, int compid, bool forcemavlink2 = false, bool forcesigning = false ) : void |
Generate a Mavlink Packet and write to serial
|
|
getDatastream ( MAVLink id, byte hzrate ) : void | ||
getDatastream ( byte sysid, byte compid, MAVLink id, byte hzrate ) : void | ||
getParamListBG ( ) : |
Get param list from apm
|
|
getWPsfromstream ( MAVLinkMessage &buffer, byte sysid, byte compid ) : void |
Used to extract mission from log file - both sent or received
|
|
hzratecheck ( double pps, int hzrate ) : bool | ||
readlogPacketMavlink ( ) : MAVLinkMessage |
public DebugPacket ( MAVLinkMessage datin ) : object | ||
datin | MAVLinkMessage | |
return | object |
public DebugPacket ( MAVLinkMessage datin, bool PrintToConsole ) : object | ||
datin | MAVLinkMessage | |
PrintToConsole | bool | |
return | object |
public DebugPacket ( MAVLinkMessage datin, string &text ) : object | ||
datin | MAVLinkMessage | |
text | string | |
return | object |
public DebugPacket ( MAVLinkMessage datin, string &text, bool PrintToConsole, string delimeter = " " ) : object | ||
datin | MAVLinkMessage | packet byte array |
text | string | |
PrintToConsole | bool | |
delimeter | string | |
return | object |
public GetLog ( ushort no ) : |
||
no | ushort | |
return |
public GetLogEntry ( ushort startno, ushort endno = ushort.MaxValue ) : mavlink_log_entry_t | ||
startno | ushort | |
endno | ushort | |
return | mavlink_log_entry_t |
public GetParam ( byte sysid, byte compid, string name = "", short index = -1, bool requireresponce = true ) : float | ||
sysid | byte | |
compid | byte | |
name | string | |
index | short | |
requireresponce | bool | |
return | float |
public GetParam ( string name = "", short index = -1, bool requireresponce = true ) : float | ||
name | string | |
index | short | |
requireresponce | bool | |
return | float |
public InjectGpsData ( byte data, byte length ) : void | ||
data | byte | |
length | byte | |
return | void |
public InjectGpsData ( byte sysid, byte compid, byte data, byte length, bool rtcm_message = true ) : void | ||
sysid | byte | |
compid | byte | |
data | byte | |
length | byte | |
rtcm_message | bool | |
return | void |
public MAVLinkInterface ( Stream logfileStream ) : System | ||
logfileStream | Stream | |
return | System |
public Open ( bool getparams, bool skipconnectedcheck = false ) : void | ||
getparams | bool | |
skipconnectedcheck | bool | |
return | void |
public SendSerialControl ( SERIAL_CONTROL_DEV port, ushort timeoutms, byte data, uint baudrate, bool close = false ) : void | ||
port | SERIAL_CONTROL_DEV | |
timeoutms | ushort | |
data | byte | |
baudrate | uint | |
close | bool | |
return | void |
public SetSensorOffsets ( sensoroffsetsenum sensor, float x, float y, float z ) : bool | ||
sensor | sensoroffsetsenum | |
x | float | |
y | float | |
z | float | |
return | bool |
public SubscribeToPacketType ( MAVLINK_MSG_ID type, bool>.Func |
||
type | MAVLINK_MSG_ID | |
function | bool>.Func | |
exclusive | bool | |
return | KeyValuePair |
public UnSubscribeToPacketType ( bool>.KeyValuePair |
||
item | bool>.KeyValuePair | |
return | void |
public UnSubscribeToPacketType ( MAVLINK_MSG_ID msgtype, bool>.Func |
||
msgtype | MAVLINK_MSG_ID | |
item | bool>.Func | |
return | void |
public disableSigning ( int sysid, int compid ) : bool | ||
sysid | int | |
compid | int | |
return | bool |
public doARM ( byte sysid, byte compid, bool armit ) : bool | ||
sysid | byte | |
compid | byte | |
armit | bool | |
return | bool |
public doCommand ( MAV_CMD actionid, float p1, float p2, float p3, float p4, float p5, float p6, float p7, bool requireack = true ) : bool | ||
actionid | MAV_CMD | |
p1 | float | |
p2 | float | |
p3 | float | |
p4 | float | |
p5 | float | |
p6 | float | |
p7 | float | |
requireack | bool | |
return | bool |
public doCommand ( byte sysid, byte compid, MAV_CMD actionid, float p1, float p2, float p3, float p4, float p5, float p6, float p7, bool requireack = true ) : bool | ||
sysid | byte | |
compid | byte | |
actionid | MAV_CMD | |
p1 | float | |
p2 | float | |
p3 | float | |
p4 | float | |
p5 | float | |
p6 | float | |
p7 | float | |
requireack | bool | |
return | bool |
public doMotorTest ( int motor, MAVLink thr_type, int throttle, int timeout, int motorcount ) : bool | ||
motor | int | |
thr_type | MAVLink | |
throttle | int | |
timeout | int | |
motorcount | int | |
return | bool |
public doReboot ( bool bootloadermode = false, bool currentvehicle = true ) : bool | ||
bootloadermode | bool | reboot into bootloader mode? |
currentvehicle | bool | use current sysid/compid or scan for it |
return | bool |
public enableSigning ( int sysid, int compid ) : bool | ||
sysid | int | |
compid | int | |
return | bool |
public getFencePoint ( int no, int &total ) : MissionPlanner.Utilities.PointLatLngAlt | ||
no | int | |
total | int | |
return | MissionPlanner.Utilities.PointLatLngAlt |
public getHomePosition ( ) : |
||
return |
public getRallyPoint ( int no, int &total ) : MissionPlanner.Utilities.PointLatLngAlt | ||
no | int | |
total | int | |
return | MissionPlanner.Utilities.PointLatLngAlt |
public getWP ( ushort index ) : |
||
index | ushort | |
return |
public static modifyParamForDisplay ( bool fromapm, string paramname, float &value ) : void | ||
fromapm | bool | |
paramname | string | |
value | float | |
return | void |
public requestDatastream ( MAVLink id, byte hzrate, int sysid = -1, int compid = -1 ) : void | ||
id | MAVLink | |
hzrate | byte | |
sysid | int | |
compid | int | |
return | void |
public sendPacket ( object indata, int sysid, int compid ) : void | ||
indata | object | |
sysid | int | |
compid | int | |
return | void |
public setAPType ( byte sysid, byte compid ) : void | ||
sysid | byte | |
compid | byte | |
return | void |
public setDigicamControl ( bool shot ) : void | ||
shot | bool | |
return | void |
public setFencePoint ( byte index, PointLatLngAlt plla, byte fencepointcount ) : bool | ||
index | byte | |
plla | PointLatLngAlt | |
fencepointcount | byte | |
return | bool |
public setGuidedModeWP ( Locationwp gotohere, bool setguidedmode = true ) : void | ||
gotohere | Locationwp | |
setguidedmode | bool | |
return | void |
public setMode ( byte sysid, byte compid, mavlink_set_mode_t mode, MAV_MODE_FLAG base_mode ) : void | ||
sysid | byte | |
compid | byte | |
mode | mavlink_set_mode_t | |
base_mode | MAV_MODE_FLAG | |
return | void |
public setMode ( byte sysid, byte compid, string modein ) : void | ||
sysid | byte | |
compid | byte | |
modein | string | |
return | void |
public setMode ( mavlink_set_mode_t mode, MAV_MODE_FLAG base_mode ) : void | ||
mode | mavlink_set_mode_t | |
base_mode | MAV_MODE_FLAG | |
return | void |
public setMountConfigure ( MAV_MOUNT_MODE mountmode, bool stabroll, bool stabpitch, bool stabyaw ) : void | ||
mountmode | MAV_MOUNT_MODE | |
stabroll | bool | |
stabpitch | bool | |
stabyaw | bool | |
return | void |
public setMountControl ( double pa, double pb, double pc, bool islatlng ) : void | ||
pa | double | |
pb | double | |
pc | double | |
islatlng | bool | |
return | void |
public setNewWPAlt ( Locationwp gotohere ) : void | ||
gotohere | Locationwp | |
return | void |
public setNextWPTargetAlt ( ushort wpno, float alt ) : void | ||
wpno | ushort | |
alt | float | |
return | void |
public setParam ( byte sysid, byte compid, string paramname, double value, bool force = false ) : bool | ||
sysid | byte | |
compid | byte | |
paramname | string | name as a string |
value | double | |
force | bool | |
return | bool |
public setParam ( string paramnames, double value ) : bool | ||
paramnames | string | |
value | double | |
return | bool |
public setParam ( string paramname, double value, bool force = false ) : bool | ||
paramname | string | |
value | double | |
force | bool | |
return | bool |
public setPositionTargetGlobalInt ( byte sysid, byte compid, bool pos, bool vel, bool acc, MAV_FRAME frame, double lat, double lng, double alt, double vx, double vy, double vz ) : void | ||
sysid | byte | |
compid | byte | |
pos | bool | |
vel | bool | |
acc | bool | |
frame | MAV_FRAME | |
lat | double | |
lng | double | |
alt | double | |
vx | double | |
vy | double | |
vz | double | |
return | void |
public setRallyPoint ( byte index, PointLatLngAlt plla, short break_alt, UInt16 land_dir_cd, byte flags, byte rallypointcount ) : bool | ||
index | byte | |
plla | PointLatLngAlt | |
break_alt | short | |
land_dir_cd | UInt16 | |
flags | byte | |
rallypointcount | byte | |
return | bool |
public setWP ( Locationwp loc, ushort index, MAV_FRAME frame, byte current, byte autocontinue = 1, bool use_int = false ) : MAV_MISSION_RESULT | ||
loc | Locationwp | location struct |
index | ushort | wp no |
frame | MAV_FRAME | global or relative |
current | byte | 0 = no , 2 = guided mode |
autocontinue | byte | |
use_int | bool | |
return | MAV_MISSION_RESULT |
public setWP ( mavlink_mission_item_int_t req ) : MAV_MISSION_RESULT | ||
req | mavlink_mission_item_int_t | |
return | MAV_MISSION_RESULT |
public setWP ( mavlink_mission_item_t req ) : MAV_MISSION_RESULT | ||
req | mavlink_mission_item_t | |
return | MAV_MISSION_RESULT |
public setWPPartialUpdate ( ushort startwp, ushort endwp ) : void | ||
startwp | ushort | |
endwp | ushort | |
return | void |
public setupSigning ( string userseed, byte key = null ) : bool | ||
userseed | string | |
key | byte | |
return | bool |
public translateMode ( byte sysid, byte compid, string modein, MAVLink &mode ) : bool | ||
sysid | byte | |
compid | byte | |
modein | string | |
mode | MAVLink | |
return | bool |
public translateMode ( string modein, MAVLink &mode ) : bool | ||
modein | string | |
mode | MAVLink | |
return | bool |
public TerrainFollow,MissionPlanner.Utilities Terrain | ||
return |