mavlink

package
v0.0.0-...-193710a Latest Latest
Warning

This package is not in the latest version of its module.

Go to latest
Published: Aug 24, 2014 License: Apache-2.0 Imports: 6 Imported by: 0

Documentation

Index

Constants

View Source
const FENCE_ACTION_ENUM_END = 4 /*  | */
View Source
const FENCE_ACTION_GUIDED = 1 /* Switched to guided mode to return point (fence point 0) | */
View Source
const FENCE_ACTION_GUIDED_THR_PASS = 3 /* Switched to guided mode to return point (fence point 0) with manual throttle control | */
View Source
const FENCE_ACTION_NONE = 0 /* Disable fenced mode | */

* @brief FENCE_ACTION

View Source
const FENCE_ACTION_REPORT = 2 /* Report fence breach, but don't take action | */
View Source
const FENCE_BREACH_BOUNDARY = 3 /* Breached fence boundary | */
View Source
const FENCE_BREACH_ENUM_END = 4 /*  | */
View Source
const FENCE_BREACH_MAXALT = 2 /* Breached maximum altitude | */
View Source
const FENCE_BREACH_MINALT = 1 /* Breached minimum altitude | */
View Source
const FENCE_BREACH_NONE = 0 /* No last fence breach | */

* @brief FENCE_BREACH

View Source
const MAVLINK_ALIGNED_FIELDS = 1
View Source
const MAVLINK_BIG_ENDIAN = 0
View Source
const MAVLINK_BUILD_DATE = "Thu Jul 31 22:19:34 2014"
View Source
const MAVLINK_CRC_EXTRA = 1
View Source
const MAVLINK_DATA_STREAM_IMG_BMP = 2 /*  | */
View Source
const MAVLINK_DATA_STREAM_IMG_JPEG = 1 /*  | */

* @brief MAVLINK_DATA_STREAM_TYPE

View Source
const MAVLINK_DATA_STREAM_IMG_PGM = 5 /*  | */
View Source
const MAVLINK_DATA_STREAM_IMG_PNG = 6 /*  | */
View Source
const MAVLINK_DATA_STREAM_IMG_RAW32U = 4 /*  | */
View Source
const MAVLINK_DATA_STREAM_IMG_RAW8U = 3 /*  | */
View Source
const MAVLINK_DATA_STREAM_TYPE_ENUM_END = 7 /*  | */
View Source
const MAVLINK_ENDIAN = MAVLINK_LITTLE_ENDIAN
View Source
const MAVLINK_LITTLE_ENDIAN = 1
View Source
const MAVLINK_MAX_DIALECT_PAYLOAD_SIZE = 255
View Source
const MAVLINK_MSG_ATTITUDE_SETPOINT_EXTERNAL_FIELD_q_LEN = 4
View Source
const MAVLINK_MSG_AUTH_KEY_FIELD_key_LEN = 32
View Source
const MAVLINK_MSG_CHANGE_OPERATOR_CONTROL_FIELD_passkey_LEN = 25
View Source
const MAVLINK_MSG_DEBUG_VECT_FIELD_name_LEN = 10
View Source
const MAVLINK_MSG_ENCAPSULATED_DATA_FIELD_data_LEN = 253
View Source
const MAVLINK_MSG_FILE_TRANSFER_DIR_LIST_FIELD_dir_path_LEN = 240
View Source
const MAVLINK_MSG_FILE_TRANSFER_START_FIELD_dest_path_LEN = 240
View Source
const MAVLINK_MSG_GPS_INJECT_DATA_FIELD_data_LEN = 110
View Source
const MAVLINK_MSG_GPS_STATUS_FIELD_satellite_azimuth_LEN = 20
View Source
const MAVLINK_MSG_GPS_STATUS_FIELD_satellite_elevation_LEN = 20
View Source
const MAVLINK_MSG_GPS_STATUS_FIELD_satellite_prn_LEN = 20
View Source
const MAVLINK_MSG_GPS_STATUS_FIELD_satellite_snr_LEN = 20
View Source
const MAVLINK_MSG_GPS_STATUS_FIELD_satellite_used_LEN = 20
View Source
const MAVLINK_MSG_HIL_STATE_QUATERNION_FIELD_attitude_quaternion_LEN = 4
View Source
const MAVLINK_MSG_LOG_DATA_FIELD_data_LEN = 90
View Source
const MAVLINK_MSG_MEMORY_VECT_FIELD_value_LEN = 32
View Source
const MAVLINK_MSG_NAMED_VALUE_FLOAT_FIELD_name_LEN = 10
View Source
const MAVLINK_MSG_NAMED_VALUE_INT_FIELD_name_LEN = 10
View Source
const MAVLINK_MSG_OMNIDIRECTIONAL_FLOW_FIELD_left_LEN = 10
View Source
const MAVLINK_MSG_OMNIDIRECTIONAL_FLOW_FIELD_right_LEN = 10
View Source
const MAVLINK_MSG_PARAM_REQUEST_READ_FIELD_param_id_LEN = 16
View Source
const MAVLINK_MSG_PARAM_SET_FIELD_param_id_LEN = 16
View Source
const MAVLINK_MSG_PARAM_VALUE_FIELD_param_id_LEN = 16
View Source
const MAVLINK_MSG_SERIAL_CONTROL_FIELD_data_LEN = 70
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_LED_ROLL_PITCH_YAW_THRUST_FIELD_led_blue_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_LED_ROLL_PITCH_YAW_THRUST_FIELD_led_green_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_LED_ROLL_PITCH_YAW_THRUST_FIELD_led_red_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_LED_ROLL_PITCH_YAW_THRUST_FIELD_pitch_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_LED_ROLL_PITCH_YAW_THRUST_FIELD_roll_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_LED_ROLL_PITCH_YAW_THRUST_FIELD_thrust_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_LED_ROLL_PITCH_YAW_THRUST_FIELD_yaw_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_ROLL_PITCH_YAW_THRUST_FIELD_pitch_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_ROLL_PITCH_YAW_THRUST_FIELD_roll_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_ROLL_PITCH_YAW_THRUST_FIELD_thrust_LEN = 4
View Source
const MAVLINK_MSG_SET_QUAD_SWARM_ROLL_PITCH_YAW_THRUST_FIELD_yaw_LEN = 4
View Source
const MAVLINK_MSG_STATUSTEXT_FIELD_text_LEN = 50
View Source
const MAVLINK_MSG_TERRAIN_DATA_FIELD_data_LEN = 16
View Source
const MAVLINK_STX = 254
View Source
const MAVLINK_VERSION = 3
View Source
const MAVLINK_WIRE_PROTOCOL_VERSION = "1.0"
View Source
const MAV_AUTOPILOT_AEROB = 16 /* Aerob -- http://aerob.ru | */
View Source
const MAV_AUTOPILOT_ARDUPILOTMEGA = 3 /* ArduPilotMega / ArduCopter, http://diydrones.com | */
View Source
const MAV_AUTOPILOT_ARMAZILA = 15 /* Armazila -- http://armazila.com | */
View Source
const MAV_AUTOPILOT_AUTOQUAD = 14 /* AutoQuad -- http://autoquad.org | */
View Source
const MAV_AUTOPILOT_ENUM_END = 17 /*  | */
View Source
const MAV_AUTOPILOT_FP = 11 /* FlexiPilot | */
View Source
const MAV_AUTOPILOT_GENERIC = 0 /* Generic autopilot, full support for everything | */

* @brief Micro air vehicle / autopilot classes. This identifies the individual model. MAV_AUTOPILOT

View Source
const MAV_AUTOPILOT_GENERIC_MISSION_FULL = 7 /* Generic autopilot supporting the full mission command set | */
View Source
const MAV_AUTOPILOT_GENERIC_WAYPOINTS_AND_SIMPLE_NAVIGATION_ONLY = 6 /* Generic autopilot supporting waypoints and other simple navigation commands | */
View Source
const MAV_AUTOPILOT_GENERIC_WAYPOINTS_ONLY = 5 /* Generic autopilot only supporting simple waypoints | */
View Source
const MAV_AUTOPILOT_INVALID = 8 /* No valid autopilot, e.g. a GCS or other MAVLink component | */
View Source
const MAV_AUTOPILOT_OPENPILOT = 4 /* OpenPilot, http://openpilot.org | */
View Source
const MAV_AUTOPILOT_PIXHAWK = 1 /* PIXHAWK autopilot, http://pixhawk.ethz.ch | */
View Source
const MAV_AUTOPILOT_PPZ = 9 /* PPZ UAV - http://nongnu.org/paparazzi | */
View Source
const MAV_AUTOPILOT_PX4 = 12 /* PX4 Autopilot - http://pixhawk.ethz.ch/px4/ | */
View Source
const MAV_AUTOPILOT_SLUGS = 2 /* SLUGS autopilot, http://slugsuav.soe.ucsc.edu | */
View Source
const MAV_AUTOPILOT_SMACCMPILOT = 13 /* SMACCMPilot - http://smaccmpilot.org | */
View Source
const MAV_AUTOPILOT_UDB = 10 /* UAV Dev Board | */
View Source
const MAV_CMD_ACK_ENUM_END = 10 /*  | */
View Source
const MAV_CMD_ACK_ERR_ACCESS_DENIED = 3 /* The system is refusing to accept this command from this source / communication partner. | */
View Source
const MAV_CMD_ACK_ERR_COORDINATES_OUT_OF_RANGE = 6 /* The coordinate frame of this command is ok, but he coordinate values exceed the safety limits of this system. This is a generic error, please use the more specific error messages below if possible. | */
View Source
const MAV_CMD_ACK_ERR_COORDINATE_FRAME_NOT_SUPPORTED = 5 /* The coordinate frame of this command / mission item is not supported. | */
View Source
const MAV_CMD_ACK_ERR_FAIL = 2 /* Generic error message if none of the other reasons fails or if no detailed error reporting is implemented. | */
View Source
const MAV_CMD_ACK_ERR_NOT_SUPPORTED = 4 /* Command or mission item is not supported, other commands would be accepted. | */
View Source
const MAV_CMD_ACK_ERR_X_LAT_OUT_OF_RANGE = 7 /* The X or latitude value is out of range. | */
View Source
const MAV_CMD_ACK_ERR_Y_LON_OUT_OF_RANGE = 8 /* The Y or longitude value is out of range. | */
View Source
const MAV_CMD_ACK_ERR_Z_ALT_OUT_OF_RANGE = 9 /* The Z or altitude value is out of range. | */
View Source
const MAV_CMD_ACK_OK = 1 /* Command / mission item is ok. | */

* @brief ACK / NACK / ERROR values as a result of MAV_CMDs and for mission item transmission. MAV_CMD_ACK

View Source
const MAV_CMD_COMPONENT_ARM_DISARM = 400 /* Arms / Disarms a component |1 to arm, 0 to disarm|  */
View Source
const MAV_CMD_CONDITION_CHANGE_ALT = 113 /* Ascend/descend at rate.  Delay mission state machine until desired altitude reached. |Descent / Ascend rate (m/s)| Empty| Empty| Empty| Empty| Empty| Finish Altitude|  */
View Source
const MAV_CMD_CONDITION_DELAY = 112 /* Delay mission state machine. |Delay in seconds (decimal)| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_CONDITION_DISTANCE = 114 /* Delay mission state machine until within desired distance of next NAV point. |Distance (meters)| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_CONDITION_LAST = 159 /* NOP - This command is only used to mark the upper limit of the CONDITION commands in the enumeration |Empty| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_CONDITION_YAW = 115 /* Reach a certain target angle. |target angle: [0-360], 0 is north| speed during yaw change:[deg per second]| direction: negative: counter clockwise, positive: clockwise [-1,1]| relative offset or absolute angle: [ 1,0]| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_CHANGE_SPEED = 178 /* Change speed and/or throttle set points. |Speed type (0=Airspeed, 1=Ground Speed)| Speed  (m/s, -1 indicates no change)| Throttle  ( Percent, -1 indicates no change)| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_CONTROL_VIDEO = 200 /* Control onboard camera system. |Camera ID (-1 for all)| Transmission: 0: disabled, 1: enabled compressed, 2: enabled raw| Transmission mode: 0: video stream, >0: single images every n seconds (decimal)| Recording: 0: disabled, 1: enabled compressed, 2: enabled raw| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_DIGICAM_CONFIGURE = 202 /* Mission command to configure an on-board camera controller system. |Modes: P, TV, AV, M, Etc| Shutter speed: Divisor number for one second| Aperture: F stop number| ISO number e.g. 80, 100, 200, Etc| Exposure type enumerator| Command Identity| Main engine cut-off time before camera trigger in seconds/10 (0 means no cut-off)|  */
View Source
const MAV_CMD_DO_DIGICAM_CONTROL = 203 /* Mission command to control an on-board camera controller system. |Session control e.g. show/hide lens| Zoom's absolute position| Zooming step value to offset zoom from the current position| Focus Locking, Unlocking or Re-locking| Shooting Command| Command Identity| Empty|  */
View Source
const MAV_CMD_DO_FENCE_ENABLE = 207 /* Mission command to enable the geofence |enable? (0=disable, 1=enable)| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_FLIGHTTERMINATION = 185 /* Terminate flight immediately |Flight termination activated if > 0.5| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_GO_AROUND = 191 /* Mission command to safely abort an autonmous landing. |Altitude (meters)| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_GUIDED_LIMITS = 222 /* set limits for external control |timeout - maximum time (in seconds) that external controller will be allowed to control vehicle. 0 means no timeout| absolute altitude min (in meters, WGS84) - if vehicle moves below this alt, the command will be aborted and the mission will continue.  0 means no lower altitude limit| absolute altitude max (in meters)- if vehicle moves above this alt, the command will be aborted and the mission will continue.  0 means no upper altitude limit| horizontal move limit (in meters, WGS84) - if vehicle moves more than this distance from it's location at the moment the command was executed, the command will be aborted and the mission will continue. 0 means no horizontal altitude limit| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_GUIDED_MASTER = 221 /* set id of master controller |System ID| Component ID| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_INVERTED_FLIGHT = 210 /* Change to/from inverted flight |inverted (0=normal, 1=inverted)| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_JUMP = 177 /* Jump to the desired command in the mission list.  Repeat this action only the specified number of times |Sequence number| Repeat count| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_LAST = 240 /* NOP - This command is only used to mark the upper limit of the DO commands in the enumeration |Empty| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_MOUNT_CONFIGURE = 204 /* Mission command to configure a camera or antenna mount |Mount operation mode (see MAV_MOUNT_MODE enum)| stabilize roll? (1 = yes, 0 = no)| stabilize pitch? (1 = yes, 0 = no)| stabilize yaw? (1 = yes, 0 = no)| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_MOUNT_CONTROL = 205 /* Mission command to control a camera or antenna mount |pitch or lat in degrees, depending on mount mode.| roll or lon in degrees depending on mount mode| yaw or alt (in meters) depending on mount mode| reserved| reserved| reserved| MAV_MOUNT_MODE enum value|  */
View Source
const MAV_CMD_DO_MOUNT_CONTROL_QUAT = 220 /* Mission command to control a camera or antenna mount, using a quaternion as reference. |q1 - quaternion param #1, w (1 in null-rotation)| q2 - quaternion param #2, x (0 in null-rotation)| q3 - quaternion param #3, y (0 in null-rotation)| q4 - quaternion param #4, z (0 in null-rotation)| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_PARACHUTE = 208 /* Mission command to trigger a parachute |action (0=disable, 1=enable, 2=release, for some systems see PARACHUTE_ACTION enum, not in general message set.)| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_RALLY_LAND = 190 /* Mission command to perform a landing from a rally point. |Break altitude (meters)| Landing speed (m/s)| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_REPEAT_RELAY = 182 /* Cycle a relay on and off for a desired number of cyles with a desired period. |Relay number| Cycle count| Cycle time (seconds, decimal)| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_REPEAT_SERVO = 184 /* Cycle a between its nominal setting and a desired PWM for a desired number of cycles with a desired period. |Servo number| PWM (microseconds, 1000 to 2000 typical)| Cycle count| Cycle time (seconds)| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_SET_CAM_TRIGG_DIST = 206 /* Mission command to set CAM_TRIGG_DIST for this flight |Camera trigger distance (meters)| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_SET_HOME = 179 /* Changes the home location either to the current location or a specified location. |Use current (1=use current location, 0=use specified location)| Empty| Empty| Empty| Latitude| Longitude| Altitude|  */
View Source
const MAV_CMD_DO_SET_MODE = 176 /* Set system mode. |Mode, as defined by ENUM MAV_MODE| Custom mode - this is system specific, please refer to the individual autopilot specifications for details.| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_SET_PARAMETER = 180 /* Set a system parameter.  Caution!  Use of this command requires knowledge of the numeric enumeration value of the parameter. |Parameter number| Parameter value| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_SET_RELAY = 181 /* Set a relay to a condition. |Relay number| Setting (1=on, 0=off, others possible depending on system hardware)| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_DO_SET_ROI = 201 /* Sets the region of interest (ROI) for a sensor set or the vehicle itself. This can then be used by the vehicles control system to control the vehicle attitude and the attitude of various sensors such as cameras. |Region of intereset mode. (see MAV_ROI enum)| MISSION index/ target ID. (see MAV_ROI enum)| ROI index (allows a vehicle to manage multiple ROI's)| Empty| x the location of the fixed ROI (see MAV_FRAME)| y| z|  */
View Source
const MAV_CMD_DO_SET_SERVO = 183 /* Set a servo to a desired PWM value. |Servo number| PWM (microseconds, 1000 to 2000 typical)| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_ENUM_END = 501 /*  | */
View Source
const MAV_CMD_MISSION_START = 300 /* start running a mission |first_item: the first mission item to run| last_item:  the last mission item to run (after this item is run, the mission ends)|  */
View Source
const MAV_CMD_NAV_GUIDED_ENABLE = 92 /* hand control over to an external controller |On / Off (> 0.5f on)| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_NAV_LAND = 21 /* Land at location |Empty| Empty| Empty| Desired yaw angle.| Latitude| Longitude| Altitude|  */
View Source
const MAV_CMD_NAV_LAST = 95 /* NOP - This command is only used to mark the upper limit of the NAV/ACTION commands in the enumeration |Empty| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_NAV_LOITER_TIME = 19 /* Loiter around this MISSION for X seconds |Seconds (decimal)| Empty| Radius around MISSION, in meters. If positive loiter clockwise, else counter-clockwise| Desired yaw angle.| Latitude| Longitude| Altitude|  */
View Source
const MAV_CMD_NAV_LOITER_TURNS = 18 /* Loiter around this MISSION for X turns |Turns| Empty| Radius around MISSION, in meters. If positive loiter clockwise, else counter-clockwise| Desired yaw angle.| Latitude| Longitude| Altitude|  */
View Source
const MAV_CMD_NAV_LOITER_UNLIM = 17 /* Loiter around this MISSION an unlimited amount of time |Empty| Empty| Radius around MISSION, in meters. If positive loiter clockwise, else counter-clockwise| Desired yaw angle.| Latitude| Longitude| Altitude|  */
View Source
const MAV_CMD_NAV_PATHPLANNING = 81 /* Control autonomous path planning on the MAV. |0: Disable local obstacle avoidance / local path planning (without resetting map), 1: Enable local path planning, 2: Enable and reset local path planning| 0: Disable full path planning (without resetting map), 1: Enable, 2: Enable and reset map/occupancy grid, 3: Enable and reset planned route, but not occupancy grid| Empty| Yaw angle at goal, in compass degrees, [0..360]| Latitude/X of goal| Longitude/Y of goal| Altitude/Z of goal|  */
View Source
const MAV_CMD_NAV_RETURN_TO_LAUNCH = 20 /* Return to launch location |Empty| Empty| Empty| Empty| Empty| Empty| Empty|  */
View Source
const MAV_CMD_NAV_ROI = 80 /* Sets the region of interest (ROI) for a sensor set or the vehicle itself. This can then be used by the vehicles control system to control the vehicle attitude and the attitude of various sensors such as cameras. |Region of intereset mode. (see MAV_ROI enum)| MISSION index/ target ID. (see MAV_ROI enum)| ROI index (allows a vehicle to manage multiple ROI's)| Empty| x the location of the fixed ROI (see MAV_FRAME)| y| z|  */
View Source
const MAV_CMD_NAV_SPLINE_WAYPOINT = 82 /* Navigate to MISSION using a spline path. |Hold time in decimal seconds. (ignored by fixed wing, time to stay at MISSION for rotary wing)| Empty| Empty| Empty| Latitude/X of goal| Longitude/Y of goal| Altitude/Z of goal|  */
View Source
const MAV_CMD_NAV_TAKEOFF = 22 /* Takeoff from ground / hand |Minimum pitch (if airspeed sensor present), desired pitch without sensor| Empty| Empty| Yaw angle (if magnetometer present), ignored without magnetometer| Latitude| Longitude| Altitude|  */
View Source
const MAV_CMD_NAV_WAYPOINT = 16 /* Navigate to MISSION. |Hold time in decimal seconds. (ignored by fixed wing, time to stay at MISSION for rotary wing)| Acceptance radius in meters (if the sphere with this radius is hit, the MISSION counts as reached)| 0 to pass through the WP, if > 0 radius in meters to pass by WP. Positive value for clockwise orbit, negative value for counter-clockwise orbit. Allows trajectory control.| Desired yaw angle at MISSION (rotary wing)| Latitude| Longitude| Altitude|  */

* @brief Commands to be executed by the MAV. They can be executed on user request, or as part of a mission script. If the action is used in a mission, the parameter mapping to the waypoint/mission message is as follows: Param 1, Param 2, Param 3, Param 4, X: Param 5, Y:Param 6, Z:Param 7. This command list is similar what ARINC 424 is for commercial aircraft: A data format how to interpret waypoint/mission data. MAV_CMD

View Source
const MAV_CMD_OVERRIDE_GOTO = 252 /* Hold / continue the current action |MAV_GOTO_DO_HOLD: hold MAV_GOTO_DO_CONTINUE: continue with next item in mission plan| MAV_GOTO_HOLD_AT_CURRENT_POSITION: Hold at current position MAV_GOTO_HOLD_AT_SPECIFIED_POSITION: hold at specified position| MAV_FRAME coordinate frame of hold point| Desired yaw angle in degrees| Latitude / X position| Longitude / Y position| Altitude / Z position|  */
View Source
const MAV_CMD_PREFLIGHT_CALIBRATION = 241 /* Trigger calibration. This command will be only accepted if in pre-flight mode. |Gyro calibration: 0: no, 1: yes| Magnetometer calibration: 0: no, 1: yes| Ground pressure: 0: no, 1: yes| Radio calibration: 0: no, 1: yes| Accelerometer calibration: 0: no, 1: yes| Compass/Motor interference calibration: 0: no, 1: yes| Empty|  */
View Source
const MAV_CMD_PREFLIGHT_REBOOT_SHUTDOWN = 246 /* Request the reboot or shutdown of system components. |0: Do nothing for autopilot, 1: Reboot autopilot, 2: Shutdown autopilot.| 0: Do nothing for onboard computer, 1: Reboot onboard computer, 2: Shutdown onboard computer.| Reserved| Reserved| Empty| Empty| Empty|  */
View Source
const MAV_CMD_PREFLIGHT_SET_SENSOR_OFFSETS = 242 /* Set sensor offsets. This command will be only accepted if in pre-flight mode. |Sensor to adjust the offsets for: 0: gyros, 1: accelerometer, 2: magnetometer, 3: barometer, 4: optical flow, 5: second magnetometer| X axis offset (or generic dimension 1), in the sensor's raw units| Y axis offset (or generic dimension 2), in the sensor's raw units| Z axis offset (or generic dimension 3), in the sensor's raw units| Generic dimension 4, in the sensor's raw units| Generic dimension 5, in the sensor's raw units| Generic dimension 6, in the sensor's raw units|  */
View Source
const MAV_CMD_PREFLIGHT_STORAGE = 245 /* Request storage of different parameter values and logs. This command will be only accepted if in pre-flight mode. |Parameter storage: 0: READ FROM FLASH/EEPROM, 1: WRITE CURRENT TO FLASH/EEPROM| Mission storage: 0: READ FROM FLASH/EEPROM, 1: WRITE CURRENT TO FLASH/EEPROM| Reserved| Reserved| Empty| Empty| Empty|  */
View Source
const MAV_CMD_START_RX_PAIR = 500 /* Starts receiver pairing |0:Spektrum| 0:Spektrum DSM2, 1:Spektrum DSMX|  */
View Source
const MAV_COMPONENT_ENUM_END = 251 /*  | */
View Source
const MAV_COMP_ID_ALL = 0 /*  | */

* @brief MAV_COMPONENT

View Source
const MAV_COMP_ID_CAMERA = 100 /*  | */
View Source
const MAV_COMP_ID_GPS = 220 /*  | */
View Source
const MAV_COMP_ID_IMU = 200 /*  | */
View Source
const MAV_COMP_ID_IMU_2 = 201 /*  | */
View Source
const MAV_COMP_ID_IMU_3 = 202 /*  | */
View Source
const MAV_COMP_ID_MAPPER = 180 /*  | */
View Source
const MAV_COMP_ID_MISSIONPLANNER = 190 /*  | */
View Source
const MAV_COMP_ID_PATHPLANNER = 195 /*  | */
View Source
const MAV_COMP_ID_SERVO1 = 140 /*  | */
View Source
const MAV_COMP_ID_SERVO10 = 149 /*  | */
View Source
const MAV_COMP_ID_SERVO11 = 150 /*  | */
View Source
const MAV_COMP_ID_SERVO12 = 151 /*  | */
View Source
const MAV_COMP_ID_SERVO13 = 152 /*  | */
View Source
const MAV_COMP_ID_SERVO14 = 153 /*  | */
View Source
const MAV_COMP_ID_SERVO2 = 141 /*  | */
View Source
const MAV_COMP_ID_SERVO3 = 142 /*  | */
View Source
const MAV_COMP_ID_SERVO4 = 143 /*  | */
View Source
const MAV_COMP_ID_SERVO5 = 144 /*  | */
View Source
const MAV_COMP_ID_SERVO6 = 145 /*  | */
View Source
const MAV_COMP_ID_SERVO7 = 146 /*  | */
View Source
const MAV_COMP_ID_SERVO8 = 147 /*  | */
View Source
const MAV_COMP_ID_SERVO9 = 148 /*  | */
View Source
const MAV_COMP_ID_SYSTEM_CONTROL = 250 /*  | */
View Source
const MAV_COMP_ID_UART_BRIDGE = 241 /*  | */
View Source
const MAV_COMP_ID_UDP_BRIDGE = 240 /*  | */
View Source
const MAV_DATA_STREAM_ALL = 0 /* Enable all data streams | */
  • @brief Data stream IDs. A data stream is not a fixed set of messages, but rather a recommendation to the autopilot software. Individual autopilots may or may not obey the recommended messages.

MAV_DATA_STREAM

View Source
const MAV_DATA_STREAM_ENUM_END = 13 /*  | */
View Source
const MAV_DATA_STREAM_EXTENDED_STATUS = 2 /* Enable GPS_STATUS, CONTROL_STATUS, AUX_STATUS | */
View Source
const MAV_DATA_STREAM_EXTRA1 = 10 /* Dependent on the autopilot | */
View Source
const MAV_DATA_STREAM_EXTRA2 = 11 /* Dependent on the autopilot | */
View Source
const MAV_DATA_STREAM_EXTRA3 = 12 /* Dependent on the autopilot | */
View Source
const MAV_DATA_STREAM_POSITION = 6 /* Enable LOCAL_POSITION, GLOBAL_POSITION/GLOBAL_POSITION_INT messages. | */
View Source
const MAV_DATA_STREAM_RAW_CONTROLLER = 4 /* Enable ATTITUDE_CONTROLLER_OUTPUT, POSITION_CONTROLLER_OUTPUT, NAV_CONTROLLER_OUTPUT. | */
View Source
const MAV_DATA_STREAM_RAW_SENSORS = 1 /* Enable IMU_RAW, GPS_RAW, GPS_STATUS packets. | */
View Source
const MAV_DATA_STREAM_RC_CHANNELS = 3 /* Enable RC_CHANNELS_SCALED, RC_CHANNELS_RAW, SERVO_OUTPUT_RAW | */
View Source
const MAV_DISTANCE_SENSOR_ENUM_END = 2 /*  | */
View Source
const MAV_DISTANCE_SENSOR_LASER = 0 /* Laser altimeter, e.g. LightWare SF02/F or PulsedLight units | */

* @brief Enumeration of distance sensor types MAV_DISTANCE_SENSOR

View Source
const MAV_DISTANCE_SENSOR_ULTRASOUND = 1 /* Ultrasound altimeter, e.g. MaxBotix units | */
View Source
const MAV_FRAME_BODY_NED = 8 /* Setpoint in body NED frame. This makes sense if all position control is externalized - e.g. useful to command 2 m/s^2 acceleration to the right. | */
View Source
const MAV_FRAME_BODY_OFFSET_NED = 9 /* Offset in body NED frame. This makes sense if adding setpoints to the current flight path, to avoid an obstacle - e.g. useful to command 2 m/s^2 acceleration to the east. | */
View Source
const MAV_FRAME_ENUM_END = 11 /*  | */
View Source
const MAV_FRAME_GLOBAL = 0 /* Global coordinate frame, WGS84 coordinate system. First value / x: latitude, second value / y: longitude, third value / z: positive altitude over mean sea level (MSL) | */

* @brief MAV_FRAME

View Source
const MAV_FRAME_GLOBAL_INT = 5 /* Global coordinate frame with some fields as scaled integers, WGS84 coordinate system. First value / x: latitude, second value / y: longitude, third value / z: positive altitude over mean sea level (MSL). Lat / Lon are scaled * 1E7 to avoid floating point accuracy limitations. | */
View Source
const MAV_FRAME_GLOBAL_RELATIVE_ALT = 3 /* Global coordinate frame, WGS84 coordinate system, relative altitude over ground with respect to the home position. First value / x: latitude, second value / y: longitude, third value / z: positive altitude with 0 being at the altitude of the home location. | */
View Source
const MAV_FRAME_GLOBAL_RELATIVE_ALT_INT = 6 /* Global coordinate frame with some fields as scaled integers, WGS84 coordinate system, relative altitude over ground with respect to the home position. First value / x: latitude, second value / y: longitude, third value / z: positive altitude with 0 being at the altitude of the home location. Lat / Lon are scaled * 1E7 to avoid floating point accuracy limitations. | */
View Source
const MAV_FRAME_GLOBAL_TERRAIN_ALT = 10 /* Global coordinate frame with above terrain level altitude. WGS84 coordinate system, relative altitude over terrain with respect to the waypoint coordinate. First value / x: latitude, second value / y: longitude, third value / z: positive altitude with 0 being at ground level in terrain model. | */
View Source
const MAV_FRAME_LOCAL_ENU = 4 /* Local coordinate frame, Z-down (x: east, y: north, z: up) | */
View Source
const MAV_FRAME_LOCAL_NED = 1 /* Local coordinate frame, Z-up (x: north, y: east, z: down). | */
View Source
const MAV_FRAME_LOCAL_OFFSET_NED = 7 /* Offset to the current local frame. Anything expressed in this frame should be added to the current local frame position. | */
View Source
const MAV_FRAME_MISSION = 2 /* NOT a coordinate frame, indicates a mission command. | */
View Source
const MAV_GOTO_DO_CONTINUE = 1 /* Continue with the next item in mission execution. | */
View Source
const MAV_GOTO_DO_HOLD = 0 /* Hold at the current position. | */

* @brief Override command, pauses current mission execution and moves immediately to a position MAV_GOTO

View Source
const MAV_GOTO_ENUM_END = 4 /*  | */
View Source
const MAV_GOTO_HOLD_AT_CURRENT_POSITION = 2 /* Hold at the current position of the system | */
View Source
const MAV_GOTO_HOLD_AT_SPECIFIED_POSITION = 3 /* Hold at the position specified in the parameters of the DO_HOLD action | */
View Source
const MAV_MISSION_ACCEPTED = 0 /* mission accepted OK | */

* @brief result in a mavlink mission ack MAV_MISSION_RESULT

View Source
const MAV_MISSION_DENIED = 14 /* not accepting any mission commands from this communication partner | */
View Source
const MAV_MISSION_ERROR = 1 /* generic error / not accepting mission commands at all right now | */
View Source
const MAV_MISSION_INVALID = 5 /* one of the parameters has an invalid value | */
View Source
const MAV_MISSION_INVALID_PARAM1 = 6 /* param1 has an invalid value | */
View Source
const MAV_MISSION_INVALID_PARAM2 = 7 /* param2 has an invalid value | */
View Source
const MAV_MISSION_INVALID_PARAM3 = 8 /* param3 has an invalid value | */
View Source
const MAV_MISSION_INVALID_PARAM4 = 9 /* param4 has an invalid value | */
View Source
const MAV_MISSION_INVALID_PARAM5_X = 10 /* x/param5 has an invalid value | */
View Source
const MAV_MISSION_INVALID_PARAM6_Y = 11 /* y/param6 has an invalid value | */
View Source
const MAV_MISSION_INVALID_PARAM7 = 12 /* param7 has an invalid value | */
View Source
const MAV_MISSION_INVALID_SEQUENCE = 13 /* received waypoint out of sequence | */
View Source
const MAV_MISSION_NO_SPACE = 4 /* mission item exceeds storage space | */
View Source
const MAV_MISSION_RESULT_ENUM_END = 15 /*  | */
View Source
const MAV_MISSION_UNSUPPORTED = 3 /* command is not supported | */
View Source
const MAV_MISSION_UNSUPPORTED_FRAME = 2 /* coordinate frame is not supported | */
View Source
const MAV_MODE_AUTO_ARMED = 220 /* System is allowed to be active, under autonomous control and navigation (the trajectory is decided onboard and not pre-programmed by MISSIONs) | */
View Source
const MAV_MODE_AUTO_DISARMED = 92 /* System is allowed to be active, under autonomous control and navigation (the trajectory is decided onboard and not pre-programmed by MISSIONs) | */
View Source
const MAV_MODE_ENUM_END = 221 /*  | */
View Source
const MAV_MODE_FLAG_AUTO_ENABLED = 4 /* 0b00000100 autonomous mode enabled, system finds its own goal positions. Guided flag can be set or not, depends on the actual implementation. | */
View Source
const MAV_MODE_FLAG_CUSTOM_MODE_ENABLED = 1 /* 0b00000001 Reserved for future use. | */

* @brief These flags encode the MAV mode. MAV_MODE_FLAG

View Source
const MAV_MODE_FLAG_DECODE_POSITION_AUTO = 4 /* Sixt bit:   00000100 | */
View Source
const MAV_MODE_FLAG_DECODE_POSITION_CUSTOM_MODE = 1 /* Eighth bit: 00000001 | */

* @brief These values encode the bit positions of the decode position. These values can be used to read the value of a flag bit by combining the base_mode variable with AND with the flag position value. The result will be either 0 or 1, depending on if the flag is set or not. MAV_MODE_FLAG_DECODE_POSITION

View Source
const MAV_MODE_FLAG_DECODE_POSITION_ENUM_END = 129 /*  | */
View Source
const MAV_MODE_FLAG_DECODE_POSITION_GUIDED = 8 /* Fifth bit:  00001000 | */
View Source
const MAV_MODE_FLAG_DECODE_POSITION_HIL = 32 /* Third bit:  00100000 | */
View Source
const MAV_MODE_FLAG_DECODE_POSITION_MANUAL = 64 /* Second bit: 01000000 | */
View Source
const MAV_MODE_FLAG_DECODE_POSITION_SAFETY = 128 /* First bit:  10000000 | */
View Source
const MAV_MODE_FLAG_DECODE_POSITION_STABILIZE = 16 /* Fourth bit: 00010000 | */
View Source
const MAV_MODE_FLAG_DECODE_POSITION_TEST = 2 /* Seventh bit: 00000010 | */
View Source
const MAV_MODE_FLAG_ENUM_END = 129 /*  | */
View Source
const MAV_MODE_FLAG_GUIDED_ENABLED = 8 /* 0b00001000 guided mode enabled, system flies MISSIONs / mission items. | */
View Source
const MAV_MODE_FLAG_HIL_ENABLED = 32 /* 0b00100000 hardware in the loop simulation. All motors / actuators are blocked, but internal software is full operational. | */
View Source
const MAV_MODE_FLAG_MANUAL_INPUT_ENABLED = 64 /* 0b01000000 remote control input is enabled. | */
View Source
const MAV_MODE_FLAG_SAFETY_ARMED = 128 /* 0b10000000 MAV safety set to armed. Motors are enabled / running / can start. Ready to fly. | */
View Source
const MAV_MODE_FLAG_STABILIZE_ENABLED = 16 /* 0b00010000 system stabilizes electronically its attitude (and optionally position). It needs however further control inputs to move around. | */
View Source
const MAV_MODE_FLAG_TEST_ENABLED = 2 /* 0b00000010 system has a test mode enabled. This flag is intended for temporary system tests and should not be used for stable implementations. | */
View Source
const MAV_MODE_GUIDED_ARMED = 216 /* System is allowed to be active, under autonomous control, manual setpoint | */
View Source
const MAV_MODE_GUIDED_DISARMED = 88 /* System is allowed to be active, under autonomous control, manual setpoint | */
View Source
const MAV_MODE_MANUAL_ARMED = 192 /* System is allowed to be active, under manual (RC) control, no stabilization | */
View Source
const MAV_MODE_MANUAL_DISARMED = 64 /* System is allowed to be active, under manual (RC) control, no stabilization | */
View Source
const MAV_MODE_PREFLIGHT = 0 /* System is not ready to fly, booting, calibrating, etc. No flag is set. | */
  • @brief These defines are predefined OR-combined mode flags. There is no need to use values from this enum, but it simplifies the use of the mode flags. Note that manual input is enabled in all modes as a safety override.

MAV_MODE

View Source
const MAV_MODE_STABILIZE_ARMED = 208 /* System is allowed to be active, under assisted RC control. | */
View Source
const MAV_MODE_STABILIZE_DISARMED = 80 /* System is allowed to be active, under assisted RC control. | */
View Source
const MAV_MODE_TEST_ARMED = 194 /* UNDEFINED mode. This solely depends on the autopilot - use with caution, intended for developers only. | */
View Source
const MAV_MODE_TEST_DISARMED = 66 /* UNDEFINED mode. This solely depends on the autopilot - use with caution, intended for developers only. | */
View Source
const MAV_MOUNT_MODE_ENUM_END = 5 /*  | */
View Source
const MAV_MOUNT_MODE_GPS_POINT = 4 /* Load neutral position and start to point to Lat,Lon,Alt | */
View Source
const MAV_MOUNT_MODE_MAVLINK_TARGETING = 2 /* Load neutral position and start MAVLink Roll,Pitch,Yaw control with stabilization | */
View Source
const MAV_MOUNT_MODE_NEUTRAL = 1 /* Load and keep neutral position (Roll,Pitch,Yaw) from permanent memory. | */
View Source
const MAV_MOUNT_MODE_RC_TARGETING = 3 /* Load neutral position and start RC Roll,Pitch,Yaw control with stabilization | */
View Source
const MAV_MOUNT_MODE_RETRACT = 0 /* Load and keep safe position (Roll,Pitch,Yaw) from permant memory and stop stabilization | */

* @brief Enumeration of possible mount operation modes MAV_MOUNT_MODE

View Source
const MAV_PARAM_TYPE_ENUM_END = 11 /*  | */
View Source
const MAV_PARAM_TYPE_INT16 = 4 /* 16-bit signed integer | */
View Source
const MAV_PARAM_TYPE_INT32 = 6 /* 32-bit signed integer | */
View Source
const MAV_PARAM_TYPE_INT64 = 8 /* 64-bit signed integer | */
View Source
const MAV_PARAM_TYPE_INT8 = 2 /* 8-bit signed integer | */
View Source
const MAV_PARAM_TYPE_REAL32 = 9 /* 32-bit floating-point | */
View Source
const MAV_PARAM_TYPE_REAL64 = 10 /* 64-bit floating-point | */
View Source
const MAV_PARAM_TYPE_UINT16 = 3 /* 16-bit unsigned integer | */
View Source
const MAV_PARAM_TYPE_UINT32 = 5 /* 32-bit unsigned integer | */
View Source
const MAV_PARAM_TYPE_UINT64 = 7 /* 64-bit unsigned integer | */
View Source
const MAV_PARAM_TYPE_UINT8 = 1 /* 8-bit unsigned integer | */

* @brief Specifies the datatype of a MAVLink parameter. MAV_PARAM_TYPE

View Source
const MAV_POWER_STATUS_BRICK_VALID = 1 /* main brick power supply valid | */

* @brief Power supply status flags (bitmask) MAV_POWER_STATUS

View Source
const MAV_POWER_STATUS_CHANGED = 32 /* Power status has changed since boot | */
View Source
const MAV_POWER_STATUS_ENUM_END = 33 /*  | */
View Source
const MAV_POWER_STATUS_PERIPH_HIPOWER_OVERCURRENT = 16 /* hi-power peripheral supply is in over-current state | */
View Source
const MAV_POWER_STATUS_PERIPH_OVERCURRENT = 8 /* peripheral supply is in over-current state | */
View Source
const MAV_POWER_STATUS_SERVO_VALID = 2 /* main servo power supply valid for FMU | */
View Source
const MAV_POWER_STATUS_USB_CONNECTED = 4 /* USB power is connected | */
View Source
const MAV_RESULT_ACCEPTED = 0 /* Command ACCEPTED and EXECUTED | */

* @brief result from a mavlink command MAV_RESULT

View Source
const MAV_RESULT_DENIED = 2 /* Command PERMANENTLY DENIED | */
View Source
const MAV_RESULT_ENUM_END = 5 /*  | */
View Source
const MAV_RESULT_FAILED = 4 /* Command executed, but failed | */
View Source
const MAV_RESULT_TEMPORARILY_REJECTED = 1 /* Command TEMPORARY REJECTED/DENIED | */
View Source
const MAV_RESULT_UNSUPPORTED = 3 /* Command UNKNOWN/UNSUPPORTED | */
View Source
const MAV_ROI_ENUM_END = 5 /*  | */
View Source
const MAV_ROI_LOCATION = 3 /* Point toward fixed location. | */
View Source
const MAV_ROI_NONE = 0 /* No region of interest. | */
  • @brief The ROI (region of interest) for the vehicle. This can be be used by the vehicle for camera/vehicle attitude alignment (see MAV_CMD_NAV_ROI).

MAV_ROI

View Source
const MAV_ROI_TARGET = 4 /* Point toward of given id. | */
View Source
const MAV_ROI_WPINDEX = 2 /* Point toward given MISSION. | */
View Source
const MAV_ROI_WPNEXT = 1 /* Point toward next MISSION. | */
View Source
const MAV_SEVERITY_ALERT = 1 /* Action should be taken immediately. Indicates error in non-critical systems. | */
View Source
const MAV_SEVERITY_CRITICAL = 2 /* Action must be taken immediately. Indicates failure in a primary system. | */
View Source
const MAV_SEVERITY_DEBUG = 7 /* Useful non-operational messages that can assist in debugging. These should not occur during normal operation. | */
View Source
const MAV_SEVERITY_EMERGENCY = 0 /* System is unusable. This is a "panic" condition. | */

* @brief Indicates the severity level, generally used for status messages to indicate their relative urgency. Based on RFC-5424 using expanded definitions at: http://www.kiwisyslog.com/kb/info:-syslog-message-levels/. MAV_SEVERITY

View Source
const MAV_SEVERITY_ENUM_END = 8 /*  | */
View Source
const MAV_SEVERITY_ERROR = 3 /* Indicates an error in secondary/redundant systems. | */
View Source
const MAV_SEVERITY_INFO = 6 /* Normal operational messages. Useful for logging. No action is required for these messages. | */
View Source
const MAV_SEVERITY_NOTICE = 5 /* An unusual event has occured, though not an error condition. This should be investigated for the root cause. | */
View Source
const MAV_SEVERITY_WARNING = 4 /* Indicates about a possible future error if this is not resolved within a given timeframe. Example would be a low battery warning. | */
View Source
const MAV_STATE_ACTIVE = 4 /* System is active and might be already airborne. Motors are engaged. | */
View Source
const MAV_STATE_BOOT = 1 /* System is booting up. | */
View Source
const MAV_STATE_CALIBRATING = 2 /* System is calibrating and not flight-ready. | */
View Source
const MAV_STATE_CRITICAL = 5 /* System is in a non-normal flight mode. It can however still navigate. | */
View Source
const MAV_STATE_EMERGENCY = 6 /* System is in a non-normal flight mode. It lost control over parts or over the whole airframe. It is in mayday and going down. | */
View Source
const MAV_STATE_ENUM_END = 8 /*  | */
View Source
const MAV_STATE_POWEROFF = 7 /* System just initialized its power-down sequence, will shut down now. | */
View Source
const MAV_STATE_STANDBY = 3 /* System is grounded and on standby. It can be launched any time. | */
View Source
const MAV_STATE_UNINIT = 0 /* Uninitialized system, state is unknown. | */

* @brief MAV_STATE

View Source
const MAV_SYS_STATUS_AHRS = 2097152 /* 0x200000 AHRS subsystem health | */
View Source
const MAV_SYS_STATUS_GEOFENCE = 1048576 /* 0x100000 geofence | */
View Source
const MAV_SYS_STATUS_SENSOR_3D_ACCEL = 2 /* 0x02 3D accelerometer | */
View Source
const MAV_SYS_STATUS_SENSOR_3D_ACCEL2 = 262144 /* 0x40000 2nd 3D accelerometer | */
View Source
const MAV_SYS_STATUS_SENSOR_3D_GYRO = 1 /* 0x01 3D gyro | */

* @brief These encode the sensors whose status is sent as part of the SYS_STATUS message. MAV_SYS_STATUS_SENSOR

View Source
const MAV_SYS_STATUS_SENSOR_3D_GYRO2 = 131072 /* 0x20000 2nd 3D gyro | */
View Source
const MAV_SYS_STATUS_SENSOR_3D_MAG = 4 /* 0x04 3D magnetometer | */
View Source
const MAV_SYS_STATUS_SENSOR_3D_MAG2 = 524288 /* 0x80000 2nd 3D magnetometer | */
View Source
const MAV_SYS_STATUS_SENSOR_ABSOLUTE_PRESSURE = 8 /* 0x08 absolute pressure | */
View Source
const MAV_SYS_STATUS_SENSOR_ANGULAR_RATE_CONTROL = 1024 /* 0x400 3D angular rate control | */
View Source
const MAV_SYS_STATUS_SENSOR_ATTITUDE_STABILIZATION = 2048 /* 0x800 attitude stabilization | */
View Source
const MAV_SYS_STATUS_SENSOR_DIFFERENTIAL_PRESSURE = 16 /* 0x10 differential pressure | */
View Source
const MAV_SYS_STATUS_SENSOR_ENUM_END = 4194305 /*  | */
View Source
const MAV_SYS_STATUS_SENSOR_EXTERNAL_GROUND_TRUTH = 512 /* 0x200 external ground truth (Vicon or Leica) | */
View Source
const MAV_SYS_STATUS_SENSOR_GPS = 32 /* 0x20 GPS | */
View Source
const MAV_SYS_STATUS_SENSOR_LASER_POSITION = 256 /* 0x100 laser based position | */
View Source
const MAV_SYS_STATUS_SENSOR_MOTOR_OUTPUTS = 32768 /* 0x8000 motor outputs / control | */
View Source
const MAV_SYS_STATUS_SENSOR_OPTICAL_FLOW = 64 /* 0x40 optical flow | */
View Source
const MAV_SYS_STATUS_SENSOR_RC_RECEIVER = 65536 /* 0x10000 rc receiver | */
View Source
const MAV_SYS_STATUS_SENSOR_VISION_POSITION = 128 /* 0x80 computer vision position | */
View Source
const MAV_SYS_STATUS_SENSOR_XY_POSITION_CONTROL = 16384 /* 0x4000 x/y position control | */
View Source
const MAV_SYS_STATUS_SENSOR_YAW_POSITION = 4096 /* 0x1000 yaw position | */
View Source
const MAV_SYS_STATUS_SENSOR_Z_ALTITUDE_CONTROL = 8192 /* 0x2000 z/altitude control | */
View Source
const MAV_SYS_STATUS_TERRAIN = 4194304 /* 0x400000 Terrain subsystem health | */
View Source
const MAV_TYPE_AIRSHIP = 7 /* Airship, controlled | */
View Source
const MAV_TYPE_ANTENNA_TRACKER = 5 /* Ground installation | */
View Source
const MAV_TYPE_COAXIAL = 3 /* Coaxial helicopter | */
View Source
const MAV_TYPE_ENUM_END = 19 /*  | */
View Source
const MAV_TYPE_FIXED_WING = 1 /* Fixed wing aircraft. | */
View Source
const MAV_TYPE_FLAPPING_WING = 16 /* Flapping wing | */
View Source
const MAV_TYPE_FREE_BALLOON = 8 /* Free balloon, uncontrolled | */
View Source
const MAV_TYPE_GCS = 6 /* Operator control unit / ground control station | */
View Source
const MAV_TYPE_GENERIC = 0 /* Generic micro air vehicle. | */

* @brief MAV_TYPE

View Source
const MAV_TYPE_GROUND_ROVER = 10 /* Ground rover | */
View Source
const MAV_TYPE_HELICOPTER = 4 /* Normal helicopter with tail rotor. | */
View Source
const MAV_TYPE_HEXAROTOR = 13 /* Hexarotor | */
View Source
const MAV_TYPE_KITE = 17 /* Flapping wing | */
View Source
const MAV_TYPE_OCTOROTOR = 14 /* Octorotor | */
View Source
const MAV_TYPE_ONBOARD_CONTROLLER = 18 /* Onboard companion controller | */
View Source
const MAV_TYPE_QUADROTOR = 2 /* Quadrotor | */
View Source
const MAV_TYPE_ROCKET = 9 /* Rocket | */
View Source
const MAV_TYPE_SUBMARINE = 12 /* Submarine | */
View Source
const MAV_TYPE_SURFACE_BOAT = 11 /* Surface vessel, boat, ship | */
View Source
const MAV_TYPE_TRICOPTER = 15 /* Octorotor | */
View Source
const SERIAL_CONTROL_DEV_ENUM_END = 4 /*  | */
View Source
const SERIAL_CONTROL_DEV_GPS1 = 2 /* First GPS port | */
View Source
const SERIAL_CONTROL_DEV_GPS2 = 3 /* Second GPS port | */
View Source
const SERIAL_CONTROL_DEV_TELEM1 = 0 /* First telemetry port | */

* @brief SERIAL_CONTROL device types SERIAL_CONTROL_DEV

View Source
const SERIAL_CONTROL_DEV_TELEM2 = 1 /* Second telemetry port | */
View Source
const SERIAL_CONTROL_FLAG_BLOCKING = 8 /* Block on writes to the serial port | */
View Source
const SERIAL_CONTROL_FLAG_ENUM_END = 17 /*  | */
View Source
const SERIAL_CONTROL_FLAG_EXCLUSIVE = 4 /* Set if access to the serial port should be removed from whatever driver is currently using it, giving exclusive access to the SERIAL_CONTROL protocol. The port can be handed back by sending a request without this flag set | */
View Source
const SERIAL_CONTROL_FLAG_MULTI = 16 /* Send multiple replies until port is drained | */
View Source
const SERIAL_CONTROL_FLAG_REPLY = 1 /* Set if this is a reply | */

* @brief SERIAL_CONTROL flags (bitmask) SERIAL_CONTROL_FLAG

View Source
const SERIAL_CONTROL_FLAG_RESPOND = 2 /* Set if the sender wants the receiver to send a response as another SERIAL_CONTROL message | */
View Source
const X25_INIT_CRC = 0xffff
View Source
const X25_VALIDATE_CRC = 0xf0b8

Variables

This section is empty.

Functions

This section is empty.

Types

type Attitude

type Attitude struct {
	TIME_BOOT_MS uint32  ///< Timestamp (milliseconds since system boot)
	ROLL         float32 ///< Roll angle (rad, -pi..+pi)
	PITCH        float32 ///< Pitch angle (rad, -pi..+pi)
	YAW          float32 ///< Yaw angle (rad, -pi..+pi)
	ROLLSPEED    float32 ///< Roll angular speed (rad/s)
	PITCHSPEED   float32 ///< Pitch angular speed (rad/s)
	YAWSPEED     float32 ///< Yaw angular speed (rad/s)
}

func (*Attitude) Crc

func (*Attitude) Crc() uint8

func (*Attitude) Decode

func (m *Attitude) Decode(buf []byte)

func (*Attitude) Id

func (*Attitude) Id() uint8

func (*Attitude) Len

func (*Attitude) Len() uint8

func (*Attitude) Pack

func (m *Attitude) Pack() []byte

type AttitudeQuaternion

type AttitudeQuaternion struct {
	TIME_BOOT_MS uint32  ///< Timestamp (milliseconds since system boot)
	Q1           float32 ///< Quaternion component 1, w (1 in null-rotation)
	Q2           float32 ///< Quaternion component 2, x (0 in null-rotation)
	Q3           float32 ///< Quaternion component 3, y (0 in null-rotation)
	Q4           float32 ///< Quaternion component 4, z (0 in null-rotation)
	ROLLSPEED    float32 ///< Roll angular speed (rad/s)
	PITCHSPEED   float32 ///< Pitch angular speed (rad/s)
	YAWSPEED     float32 ///< Yaw angular speed (rad/s)
}

func (*AttitudeQuaternion) Crc

func (*AttitudeQuaternion) Crc() uint8

func (*AttitudeQuaternion) Decode

func (m *AttitudeQuaternion) Decode(buf []byte)

func (*AttitudeQuaternion) Id

func (*AttitudeQuaternion) Id() uint8

func (*AttitudeQuaternion) Len

func (*AttitudeQuaternion) Len() uint8

func (*AttitudeQuaternion) Pack

func (m *AttitudeQuaternion) Pack() []byte

type AttitudeSetpointExternal

type AttitudeSetpointExternal struct {
	TIME_BOOT_MS     uint32     ///< Timestamp in milliseconds since system boot
	Q                [4]float32 ///< Attitude quaternion (w, x, y, z order, zero-rotation is 1, 0, 0, 0)
	BODY_ROLL_RATE   float32    ///< Body roll rate in radians per second
	BODY_PITCH_RATE  float32    ///< Body roll rate in radians per second
	BODY_YAW_RATE    float32    ///< Body roll rate in radians per second
	THRUST           float32    ///< Collective thrust, normalized to 0 .. 1 (-1 .. 1 for vehicles capable of reverse trust)
	TARGET_SYSTEM    uint8      ///< System ID
	TARGET_COMPONENT uint8      ///< Component ID
	TYPE_MASK        uint8      ///< Mappings: If any of these bits are set, the corresponding input should be ignored: bit 1: body roll rate, bit 2: body pitch rate, bit 3: body yaw rate. bit 4-bit 7: reserved, bit 8: attitude
}

func (*AttitudeSetpointExternal) Crc

func (*AttitudeSetpointExternal) Decode

func (m *AttitudeSetpointExternal) Decode(buf []byte)

func (*AttitudeSetpointExternal) Id

func (*AttitudeSetpointExternal) Len

func (*AttitudeSetpointExternal) Pack

func (m *AttitudeSetpointExternal) Pack() []byte

type AuthKey

type AuthKey struct {
	KEY [32]uint8 ///< key
}

func (*AuthKey) Crc

func (*AuthKey) Crc() uint8

func (*AuthKey) Decode

func (m *AuthKey) Decode(buf []byte)

func (*AuthKey) Id

func (*AuthKey) Id() uint8

func (*AuthKey) Len

func (*AuthKey) Len() uint8

func (*AuthKey) Pack

func (m *AuthKey) Pack() []byte

type BatteryStatus

type BatteryStatus struct {
	CURRENT_CONSUMED  int32  ///< Consumed charge, in milliampere hours (1 = 1 mAh), -1: autopilot does not provide mAh consumption estimate
	ENERGY_CONSUMED   int32  ///< Consumed energy, in 100*Joules (intergrated U*I*dt)  (1 = 100 Joule), -1: autopilot does not provide energy consumption estimate
	VOLTAGE_CELL_1    uint16 ///< Battery voltage of cell 1, in millivolts (1 = 1 millivolt)
	VOLTAGE_CELL_2    uint16 ///< Battery voltage of cell 2, in millivolts (1 = 1 millivolt), -1: no cell
	VOLTAGE_CELL_3    uint16 ///< Battery voltage of cell 3, in millivolts (1 = 1 millivolt), -1: no cell
	VOLTAGE_CELL_4    uint16 ///< Battery voltage of cell 4, in millivolts (1 = 1 millivolt), -1: no cell
	VOLTAGE_CELL_5    uint16 ///< Battery voltage of cell 5, in millivolts (1 = 1 millivolt), -1: no cell
	VOLTAGE_CELL_6    uint16 ///< Battery voltage of cell 6, in millivolts (1 = 1 millivolt), -1: no cell
	CURRENT_BATTERY   int16  ///< Battery current, in 10*milliamperes (1 = 10 milliampere), -1: autopilot does not measure the current
	ACCU_ID           uint8  ///< Accupack ID
	BATTERY_REMAINING int8   ///< Remaining battery energy: (0%: 0, 100%: 100), -1: autopilot does not estimate the remaining battery
}

func (*BatteryStatus) Crc

func (*BatteryStatus) Crc() uint8

func (*BatteryStatus) Decode

func (m *BatteryStatus) Decode(buf []byte)

func (*BatteryStatus) Id

func (*BatteryStatus) Id() uint8

func (*BatteryStatus) Len

func (*BatteryStatus) Len() uint8

func (*BatteryStatus) Pack

func (m *BatteryStatus) Pack() []byte

type ChangeOperatorControl

type ChangeOperatorControl struct {
	TARGET_SYSTEM   uint8     ///< System the GCS requests control for
	CONTROL_REQUEST uint8     ///< 0: request control of this MAV, 1: Release control of this MAV
	VERSION         uint8     ///< 0: key as plaintext, 1-255: future, different hashing/encryption variants. The GCS should in general use the safest mode possible initially and then gradually move down the encryption level if it gets a NACK message indicating an encryption mismatch.
	PASSKEY         [25]uint8 ///< Password / Key, depending on version plaintext or encrypted. 25 or less characters, NULL terminated. The characters may involve A-Z, a-z, 0-9, and "!?,.-"
}

func (*ChangeOperatorControl) Crc

func (*ChangeOperatorControl) Decode

func (m *ChangeOperatorControl) Decode(buf []byte)

func (*ChangeOperatorControl) Id

func (*ChangeOperatorControl) Len

func (*ChangeOperatorControl) Pack

func (m *ChangeOperatorControl) Pack() []byte

type ChangeOperatorControlAck

type ChangeOperatorControlAck struct {
	GCS_SYSTEM_ID   uint8 ///< ID of the GCS this message
	CONTROL_REQUEST uint8 ///< 0: request control of this MAV, 1: Release control of this MAV
	ACK             uint8 ///< 0: ACK, 1: NACK: Wrong passkey, 2: NACK: Unsupported passkey encryption method, 3: NACK: Already under control
}

func (*ChangeOperatorControlAck) Crc

func (*ChangeOperatorControlAck) Decode

func (m *ChangeOperatorControlAck) Decode(buf []byte)

func (*ChangeOperatorControlAck) Id

func (*ChangeOperatorControlAck) Len

func (*ChangeOperatorControlAck) Pack

func (m *ChangeOperatorControlAck) Pack() []byte

type CommandAck

type CommandAck struct {
	COMMAND uint16 ///< Command ID, as defined by MAV_CMD enum.
	RESULT  uint8  ///< See MAV_RESULT enum
}

func (*CommandAck) Crc

func (*CommandAck) Crc() uint8

func (*CommandAck) Decode

func (m *CommandAck) Decode(buf []byte)

func (*CommandAck) Id

func (*CommandAck) Id() uint8

func (*CommandAck) Len

func (*CommandAck) Len() uint8

func (*CommandAck) Pack

func (m *CommandAck) Pack() []byte

type CommandLong

type CommandLong struct {
	PARAM1           float32 ///< Parameter 1, as defined by MAV_CMD enum.
	PARAM2           float32 ///< Parameter 2, as defined by MAV_CMD enum.
	PARAM3           float32 ///< Parameter 3, as defined by MAV_CMD enum.
	PARAM4           float32 ///< Parameter 4, as defined by MAV_CMD enum.
	PARAM5           float32 ///< Parameter 5, as defined by MAV_CMD enum.
	PARAM6           float32 ///< Parameter 6, as defined by MAV_CMD enum.
	PARAM7           float32 ///< Parameter 7, as defined by MAV_CMD enum.
	COMMAND          uint16  ///< Command ID, as defined by MAV_CMD enum.
	TARGET_SYSTEM    uint8   ///< System which should execute the command
	TARGET_COMPONENT uint8   ///< Component which should execute the command, 0 for all components
	CONFIRMATION     uint8   ///< 0: First transmission of this command. 1-255: Confirmation transmissions (e.g. for kill command)
}

func (*CommandLong) Crc

func (*CommandLong) Crc() uint8

func (*CommandLong) Decode

func (m *CommandLong) Decode(buf []byte)

func (*CommandLong) Id

func (*CommandLong) Id() uint8

func (*CommandLong) Len

func (*CommandLong) Len() uint8

func (*CommandLong) Pack

func (m *CommandLong) Pack() []byte

type DataStream

type DataStream struct {
	MESSAGE_RATE uint16 ///< The requested interval between two messages of this type
	STREAM_ID    uint8  ///< The ID of the requested data stream
	ON_OFF       uint8  ///< 1 stream is enabled, 0 stream is stopped.
}

func (*DataStream) Crc

func (*DataStream) Crc() uint8

func (*DataStream) Decode

func (m *DataStream) Decode(buf []byte)

func (*DataStream) Id

func (*DataStream) Id() uint8

func (*DataStream) Len

func (*DataStream) Len() uint8

func (*DataStream) Pack

func (m *DataStream) Pack() []byte

type DataTransmissionHandshake

type DataTransmissionHandshake struct {
	SIZE        uint32 ///< total data size in bytes (set on ACK only)
	WIDTH       uint16 ///< Width of a matrix or image
	HEIGHT      uint16 ///< Height of a matrix or image
	PACKETS     uint16 ///< number of packets beeing sent (set on ACK only)
	TYPE        uint8  ///< type of requested/acknowledged data (as defined in ENUM DATA_TYPES in mavlink/include/mavlink_types.h)
	PAYLOAD     uint8  ///< payload size per packet (normally 253 byte, see DATA field size in message ENCAPSULATED_DATA) (set on ACK only)
	JPG_QUALITY uint8  ///< JPEG quality out of [1,100]
}

func (*DataTransmissionHandshake) Crc

func (*DataTransmissionHandshake) Decode

func (m *DataTransmissionHandshake) Decode(buf []byte)

func (*DataTransmissionHandshake) Id

func (*DataTransmissionHandshake) Len

func (*DataTransmissionHandshake) Pack

func (m *DataTransmissionHandshake) Pack() []byte

type Debug

type Debug struct {
	TIME_BOOT_MS uint32  ///< Timestamp (milliseconds since system boot)
	VALUE        float32 ///< DEBUG value
	IND          uint8   ///< index of debug variable
}

func (*Debug) Crc

func (*Debug) Crc() uint8

func (*Debug) Decode

func (m *Debug) Decode(buf []byte)

func (*Debug) Id

func (*Debug) Id() uint8

func (*Debug) Len

func (*Debug) Len() uint8

func (*Debug) Pack

func (m *Debug) Pack() []byte

type DebugVect

type DebugVect struct {
	TIME_USEC uint64    ///< Timestamp
	X         float32   ///< x
	Y         float32   ///< y
	Z         float32   ///< z
	NAME      [10]uint8 ///< Name
}

func (*DebugVect) Crc

func (*DebugVect) Crc() uint8

func (*DebugVect) Decode

func (m *DebugVect) Decode(buf []byte)

func (*DebugVect) Id

func (*DebugVect) Id() uint8

func (*DebugVect) Len

func (*DebugVect) Len() uint8

func (*DebugVect) Pack

func (m *DebugVect) Pack() []byte

type DistanceSensor

type DistanceSensor struct {
	TIME_BOOT_MS     uint32 ///< Time since system boot
	MIN_DISTANCE     uint16 ///< Minimum distance the sensor can measure in centimeters
	MAX_DISTANCE     uint16 ///< Maximum distance the sensor can measure in centimeters
	CURRENT_DISTANCE uint16 ///< Current distance reading
	TYPE             uint8  ///< Type from MAV_DISTANCE_SENSOR enum.
	ID               uint8  ///< Onboard ID of the sensor
	ORIENTATION      uint8  ///< Direction the sensor faces from FIXME enum.
	COVARIANCE       uint8  ///< Measurement covariance in centimeters, 0 for unknown / invalid readings
}

func (*DistanceSensor) Crc

func (*DistanceSensor) Crc() uint8

func (*DistanceSensor) Decode

func (m *DistanceSensor) Decode(buf []byte)

func (*DistanceSensor) Id

func (*DistanceSensor) Id() uint8

func (*DistanceSensor) Len

func (*DistanceSensor) Len() uint8

func (*DistanceSensor) Pack

func (m *DistanceSensor) Pack() []byte

type EncapsulatedData

type EncapsulatedData struct {
	SEQNR uint16     ///< sequence number (starting with 0 on every transmission)
	DATA  [253]uint8 ///< image data bytes
}

func (*EncapsulatedData) Crc

func (*EncapsulatedData) Crc() uint8

func (*EncapsulatedData) Decode

func (m *EncapsulatedData) Decode(buf []byte)

func (*EncapsulatedData) Id

func (*EncapsulatedData) Id() uint8

func (*EncapsulatedData) Len

func (*EncapsulatedData) Len() uint8

func (*EncapsulatedData) Pack

func (m *EncapsulatedData) Pack() []byte

type FileTransferDirList

type FileTransferDirList struct {
	TRANSFER_UID uint64     ///< Unique transfer ID
	DIR_PATH     [240]uint8 ///< Directory path to list
	FLAGS        uint8      ///< RESERVED
}

func (*FileTransferDirList) Crc

func (*FileTransferDirList) Crc() uint8

func (*FileTransferDirList) Decode

func (m *FileTransferDirList) Decode(buf []byte)

func (*FileTransferDirList) Id

func (*FileTransferDirList) Id() uint8

func (*FileTransferDirList) Len

func (*FileTransferDirList) Len() uint8

func (*FileTransferDirList) Pack

func (m *FileTransferDirList) Pack() []byte

type FileTransferRes

type FileTransferRes struct {
	TRANSFER_UID uint64 ///< Unique transfer ID
	RESULT       uint8  ///< 0: OK, 1: not permitted, 2: bad path / file name, 3: no space left on device
}

func (*FileTransferRes) Crc

func (*FileTransferRes) Crc() uint8

func (*FileTransferRes) Decode

func (m *FileTransferRes) Decode(buf []byte)

func (*FileTransferRes) Id

func (*FileTransferRes) Id() uint8

func (*FileTransferRes) Len

func (*FileTransferRes) Len() uint8

func (*FileTransferRes) Pack

func (m *FileTransferRes) Pack() []byte

type FileTransferStart

type FileTransferStart struct {
	TRANSFER_UID uint64     ///< Unique transfer ID
	FILE_SIZE    uint32     ///< File size in bytes
	DEST_PATH    [240]uint8 ///< Destination path
	DIRECTION    uint8      ///< Transfer direction: 0: from requester, 1: to requester
	FLAGS        uint8      ///< RESERVED
}

func (*FileTransferStart) Crc

func (*FileTransferStart) Crc() uint8

func (*FileTransferStart) Decode

func (m *FileTransferStart) Decode(buf []byte)

func (*FileTransferStart) Id

func (*FileTransferStart) Id() uint8

func (*FileTransferStart) Len

func (*FileTransferStart) Len() uint8

func (*FileTransferStart) Pack

func (m *FileTransferStart) Pack() []byte

type GlobalPositionInt

type GlobalPositionInt struct {
	TIME_BOOT_MS uint32 ///< Timestamp (milliseconds since system boot)
	LAT          int32  ///< Latitude, expressed as * 1E7
	LON          int32  ///< Longitude, expressed as * 1E7
	ALT          int32  ///< Altitude in meters, expressed as * 1000 (millimeters), above MSL
	RELATIVE_ALT int32  ///< Altitude above ground in meters, expressed as * 1000 (millimeters)
	VX           int16  ///< Ground X Speed (Latitude), expressed as m/s * 100
	VY           int16  ///< Ground Y Speed (Longitude), expressed as m/s * 100
	VZ           int16  ///< Ground Z Speed (Altitude), expressed as m/s * 100
	HDG          uint16 ///< Compass heading in degrees * 100, 0.0..359.99 degrees. If unknown, set to: UINT16_MAX
}

func (*GlobalPositionInt) Crc

func (*GlobalPositionInt) Crc() uint8

func (*GlobalPositionInt) Decode

func (m *GlobalPositionInt) Decode(buf []byte)

func (*GlobalPositionInt) Id

func (*GlobalPositionInt) Id() uint8

func (*GlobalPositionInt) Len

func (*GlobalPositionInt) Len() uint8

func (*GlobalPositionInt) Pack

func (m *GlobalPositionInt) Pack() []byte

type GlobalPositionSetpointExternalInt

type GlobalPositionSetpointExternalInt struct {
	TIME_BOOT_MS     uint32  ///< Timestamp in milliseconds since system boot. The rationale for the timestamp in the setpoint is to allow the system to compensate for the transport delay of the setpoint. This allows the system to compensate processing latency.
	LAT_INT          int32   ///< X Position in WGS84 frame in 1e7 * meters
	LON_INT          int32   ///< Y Position in WGS84 frame in 1e7 * meters
	ALT              float32 ///< Altitude in WGS84, not AMSL
	VX               float32 ///< X velocity in NED frame in meter / s
	VY               float32 ///< Y velocity in NED frame in meter / s
	VZ               float32 ///< Z velocity in NED frame in meter / s
	AFX              float32 ///< X acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N
	AFY              float32 ///< Y acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N
	AFZ              float32 ///< Z acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N
	TYPE_MASK        uint16  ///< Bitmask to indicate which dimensions should be ignored by the vehicle: a value of 0b0000000000000000 or 0b0000001000000000 indicates that none of the setpoint dimensions should be ignored. If bit 10 is set the floats afx afy afz should be interpreted as force instead of acceleration. Mapping: bit 1: x, bit 2: y, bit 3: z, bit 4: vx, bit 5: vy, bit 6: vz, bit 7: ax, bit 8: ay, bit 9: az, bit 10: is force setpoint
	TARGET_SYSTEM    uint8   ///< System ID
	TARGET_COMPONENT uint8   ///< Component ID
}

func (*GlobalPositionSetpointExternalInt) Crc

func (*GlobalPositionSetpointExternalInt) Decode

func (m *GlobalPositionSetpointExternalInt) Decode(buf []byte)

func (*GlobalPositionSetpointExternalInt) Id

func (*GlobalPositionSetpointExternalInt) Len

func (*GlobalPositionSetpointExternalInt) Pack

type GlobalPositionSetpointInt

type GlobalPositionSetpointInt struct {
	LATITUDE         int32 ///< Latitude (WGS84), in degrees * 1E7
	LONGITUDE        int32 ///< Longitude (WGS84), in degrees * 1E7
	ALTITUDE         int32 ///< Altitude (WGS84), in meters * 1000 (positive for up)
	YAW              int16 ///< Desired yaw angle in degrees * 100
	COORDINATE_FRAME uint8 ///< Coordinate frame - valid values are only MAV_FRAME_GLOBAL or MAV_FRAME_GLOBAL_RELATIVE_ALT
}

func (*GlobalPositionSetpointInt) Crc

func (*GlobalPositionSetpointInt) Decode

func (m *GlobalPositionSetpointInt) Decode(buf []byte)

func (*GlobalPositionSetpointInt) Id

func (*GlobalPositionSetpointInt) Len

func (*GlobalPositionSetpointInt) Pack

func (m *GlobalPositionSetpointInt) Pack() []byte

type GlobalVisionPositionEstimate

type GlobalVisionPositionEstimate struct {
	USEC  uint64  ///< Timestamp (microseconds, synced to UNIX time or since system boot)
	X     float32 ///< Global X position
	Y     float32 ///< Global Y position
	Z     float32 ///< Global Z position
	ROLL  float32 ///< Roll angle in rad
	PITCH float32 ///< Pitch angle in rad
	YAW   float32 ///< Yaw angle in rad
}

func (*GlobalVisionPositionEstimate) Crc

func (*GlobalVisionPositionEstimate) Decode

func (m *GlobalVisionPositionEstimate) Decode(buf []byte)

func (*GlobalVisionPositionEstimate) Id

func (*GlobalVisionPositionEstimate) Len

func (*GlobalVisionPositionEstimate) Pack

func (m *GlobalVisionPositionEstimate) Pack() []byte

type Gps2Raw

type Gps2Raw struct {
	TIME_USEC          uint64 ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	LAT                int32  ///< Latitude (WGS84), in degrees * 1E7
	LON                int32  ///< Longitude (WGS84), in degrees * 1E7
	ALT                int32  ///< Altitude (WGS84), in meters * 1000 (positive for up)
	DGPS_AGE           uint32 ///< Age of DGPS info
	EPH                uint16 ///< GPS HDOP horizontal dilution of position in cm (m*100). If unknown, set to: UINT16_MAX
	EPV                uint16 ///< GPS VDOP vertical dilution of position in cm (m*100). If unknown, set to: UINT16_MAX
	VEL                uint16 ///< GPS ground speed (m/s * 100). If unknown, set to: UINT16_MAX
	COG                uint16 ///< Course over ground (NOT heading, but direction of movement) in degrees * 100, 0.0..359.99 degrees. If unknown, set to: UINT16_MAX
	FIX_TYPE           uint8  ///< 0-1: no fix, 2: 2D fix, 3: 3D fix, 4: DGPS fix, 5: RTK Fix. Some applications will not use the value of this field unless it is at least two, so always correctly fill in the fix.
	SATELLITES_VISIBLE uint8  ///< Number of satellites visible. If unknown, set to 255
	DGPS_NUMCH         uint8  ///< Number of DGPS satellites
}

func (*Gps2Raw) Crc

func (*Gps2Raw) Crc() uint8

func (*Gps2Raw) Decode

func (m *Gps2Raw) Decode(buf []byte)

func (*Gps2Raw) Id

func (*Gps2Raw) Id() uint8

func (*Gps2Raw) Len

func (*Gps2Raw) Len() uint8

func (*Gps2Raw) Pack

func (m *Gps2Raw) Pack() []byte

type Gps2Rtk

type Gps2Rtk struct {
	TIME_LAST_BASELINE_MS uint32 ///< Time since boot of last baseline message received in ms.
	TOW                   uint32 ///< GPS Time of Week of last baseline
	BASELINE_A_MM         int32  ///< Current baseline in ECEF x or NED north component in mm.
	BASELINE_B_MM         int32  ///< Current baseline in ECEF y or NED east component in mm.
	BASELINE_C_MM         int32  ///< Current baseline in ECEF z or NED down component in mm.
	ACCURACY              uint32 ///< Current estimate of baseline accuracy.
	IAR_NUM_HYPOTHESES    int32  ///< Current number of integer ambiguity hypotheses.
	WN                    uint16 ///< GPS Week Number of last baseline
	RTK_RECEIVER_ID       uint8  ///< Identification of connected RTK receiver.
	RTK_HEALTH            uint8  ///< GPS-specific health report for RTK data.
	RTK_RATE              uint8  ///< Rate of baseline messages being received by GPS, in HZ
	NSATS                 uint8  ///< Current number of sats used for RTK calculation.
	BASELINE_COORDS_TYPE  uint8  ///< Coordinate system of baseline. 0 == ECEF, 1 == NED
}

func (*Gps2Rtk) Crc

func (*Gps2Rtk) Crc() uint8

func (*Gps2Rtk) Decode

func (m *Gps2Rtk) Decode(buf []byte)

func (*Gps2Rtk) Id

func (*Gps2Rtk) Id() uint8

func (*Gps2Rtk) Len

func (*Gps2Rtk) Len() uint8

func (*Gps2Rtk) Pack

func (m *Gps2Rtk) Pack() []byte

type GpsGlobalOrigin

type GpsGlobalOrigin struct {
	LATITUDE  int32 ///< Latitude (WGS84), in degrees * 1E7
	LONGITUDE int32 ///< Longitude (WGS84), in degrees * 1E7
	ALTITUDE  int32 ///< Altitude (WGS84), in meters * 1000 (positive for up)
}

func (*GpsGlobalOrigin) Crc

func (*GpsGlobalOrigin) Crc() uint8

func (*GpsGlobalOrigin) Decode

func (m *GpsGlobalOrigin) Decode(buf []byte)

func (*GpsGlobalOrigin) Id

func (*GpsGlobalOrigin) Id() uint8

func (*GpsGlobalOrigin) Len

func (*GpsGlobalOrigin) Len() uint8

func (*GpsGlobalOrigin) Pack

func (m *GpsGlobalOrigin) Pack() []byte

type GpsInjectData

type GpsInjectData struct {
	TARGET_SYSTEM    uint8      ///< System ID
	TARGET_COMPONENT uint8      ///< Component ID
	LEN              uint8      ///< data length
	DATA             [110]uint8 ///< raw data (110 is enough for 12 satellites of RTCMv2)
}

func (*GpsInjectData) Crc

func (*GpsInjectData) Crc() uint8

func (*GpsInjectData) Decode

func (m *GpsInjectData) Decode(buf []byte)

func (*GpsInjectData) Id

func (*GpsInjectData) Id() uint8

func (*GpsInjectData) Len

func (*GpsInjectData) Len() uint8

func (*GpsInjectData) Pack

func (m *GpsInjectData) Pack() []byte

type GpsRawInt

type GpsRawInt struct {
	TIME_USEC          uint64 ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	LAT                int32  ///< Latitude (WGS84), in degrees * 1E7
	LON                int32  ///< Longitude (WGS84), in degrees * 1E7
	ALT                int32  ///< Altitude (WGS84), in meters * 1000 (positive for up)
	EPH                uint16 ///< GPS HDOP horizontal dilution of position in cm (m*100). If unknown, set to: UINT16_MAX
	EPV                uint16 ///< GPS VDOP vertical dilution of position in cm (m*100). If unknown, set to: UINT16_MAX
	VEL                uint16 ///< GPS ground speed (m/s * 100). If unknown, set to: UINT16_MAX
	COG                uint16 ///< Course over ground (NOT heading, but direction of movement) in degrees * 100, 0.0..359.99 degrees. If unknown, set to: UINT16_MAX
	FIX_TYPE           uint8  ///< 0-1: no fix, 2: 2D fix, 3: 3D fix, 4: DGPS, 5: RTK. Some applications will not use the value of this field unless it is at least two, so always correctly fill in the fix.
	SATELLITES_VISIBLE uint8  ///< Number of satellites visible. If unknown, set to 255
}

func (*GpsRawInt) Crc

func (*GpsRawInt) Crc() uint8

func (*GpsRawInt) Decode

func (m *GpsRawInt) Decode(buf []byte)

func (*GpsRawInt) Id

func (*GpsRawInt) Id() uint8

func (*GpsRawInt) Len

func (*GpsRawInt) Len() uint8

func (*GpsRawInt) Pack

func (m *GpsRawInt) Pack() []byte

type GpsRtk

type GpsRtk struct {
	TIME_LAST_BASELINE_MS uint32 ///< Time since boot of last baseline message received in ms.
	TOW                   uint32 ///< GPS Time of Week of last baseline
	BASELINE_A_MM         int32  ///< Current baseline in ECEF x or NED north component in mm.
	BASELINE_B_MM         int32  ///< Current baseline in ECEF y or NED east component in mm.
	BASELINE_C_MM         int32  ///< Current baseline in ECEF z or NED down component in mm.
	ACCURACY              uint32 ///< Current estimate of baseline accuracy.
	IAR_NUM_HYPOTHESES    int32  ///< Current number of integer ambiguity hypotheses.
	WN                    uint16 ///< GPS Week Number of last baseline
	RTK_RECEIVER_ID       uint8  ///< Identification of connected RTK receiver.
	RTK_HEALTH            uint8  ///< GPS-specific health report for RTK data.
	RTK_RATE              uint8  ///< Rate of baseline messages being received by GPS, in HZ
	NSATS                 uint8  ///< Current number of sats used for RTK calculation.
	BASELINE_COORDS_TYPE  uint8  ///< Coordinate system of baseline. 0 == ECEF, 1 == NED
}

func (*GpsRtk) Crc

func (*GpsRtk) Crc() uint8

func (*GpsRtk) Decode

func (m *GpsRtk) Decode(buf []byte)

func (*GpsRtk) Id

func (*GpsRtk) Id() uint8

func (*GpsRtk) Len

func (*GpsRtk) Len() uint8

func (*GpsRtk) Pack

func (m *GpsRtk) Pack() []byte

type GpsStatus

type GpsStatus struct {
	SATELLITES_VISIBLE  uint8     ///< Number of satellites visible
	SATELLITE_PRN       [20]uint8 ///< Global satellite ID
	SATELLITE_USED      [20]uint8 ///< 0: Satellite not used, 1: used for localization
	SATELLITE_ELEVATION [20]uint8 ///< Elevation (0: right on top of receiver, 90: on the horizon) of satellite
	SATELLITE_AZIMUTH   [20]uint8 ///< Direction of satellite, 0: 0 deg, 255: 360 deg.
	SATELLITE_SNR       [20]uint8 ///< Signal to noise ratio of satellite
}

func (*GpsStatus) Crc

func (*GpsStatus) Crc() uint8

func (*GpsStatus) Decode

func (m *GpsStatus) Decode(buf []byte)

func (*GpsStatus) Id

func (*GpsStatus) Id() uint8

func (*GpsStatus) Len

func (*GpsStatus) Len() uint8

func (*GpsStatus) Pack

func (m *GpsStatus) Pack() []byte

type Heartbeat

type Heartbeat struct {
	CUSTOM_MODE     uint32 ///< A bitfield for use for autopilot-specific flags.
	TYPE            uint8  ///< Type of the MAV (quadrotor, helicopter, etc., up to 15 types, defined in MAV_TYPE ENUM)
	AUTOPILOT       uint8  ///< Autopilot type / class. defined in MAV_AUTOPILOT ENUM
	BASE_MODE       uint8  ///< System mode bitfield, see MAV_MODE_FLAG ENUM in mavlink/include/mavlink_types.h
	SYSTEM_STATUS   uint8  ///< System status flag, see MAV_STATE ENUM
	MAVLINK_VERSION uint8  ///< MAVLink version, not writable by user, gets added by protocol because of magic data type: uint8_t_mavlink_version
}

func (*Heartbeat) Crc

func (*Heartbeat) Crc() uint8

func (*Heartbeat) Decode

func (m *Heartbeat) Decode(buf []byte)

func (*Heartbeat) Id

func (*Heartbeat) Id() uint8

func (*Heartbeat) Len

func (*Heartbeat) Len() uint8

func (*Heartbeat) Pack

func (m *Heartbeat) Pack() []byte

type HighresImu

type HighresImu struct {
	TIME_USEC      uint64  ///< Timestamp (microseconds, synced to UNIX time or since system boot)
	XACC           float32 ///< X acceleration (m/s^2)
	YACC           float32 ///< Y acceleration (m/s^2)
	ZACC           float32 ///< Z acceleration (m/s^2)
	XGYRO          float32 ///< Angular speed around X axis (rad / sec)
	YGYRO          float32 ///< Angular speed around Y axis (rad / sec)
	ZGYRO          float32 ///< Angular speed around Z axis (rad / sec)
	XMAG           float32 ///< X Magnetic field (Gauss)
	YMAG           float32 ///< Y Magnetic field (Gauss)
	ZMAG           float32 ///< Z Magnetic field (Gauss)
	ABS_PRESSURE   float32 ///< Absolute pressure in millibar
	DIFF_PRESSURE  float32 ///< Differential pressure in millibar
	PRESSURE_ALT   float32 ///< Altitude calculated from pressure
	TEMPERATURE    float32 ///< Temperature in degrees celsius
	FIELDS_UPDATED uint16  ///< Bitmask for fields that have updated since last message, bit 0 = xacc, bit 12: temperature
}

func (*HighresImu) Crc

func (*HighresImu) Crc() uint8

func (*HighresImu) Decode

func (m *HighresImu) Decode(buf []byte)

func (*HighresImu) Id

func (*HighresImu) Id() uint8

func (*HighresImu) Len

func (*HighresImu) Len() uint8

func (*HighresImu) Pack

func (m *HighresImu) Pack() []byte

type HilControls

type HilControls struct {
	TIME_USEC      uint64  ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	ROLL_AILERONS  float32 ///< Control output -1 .. 1
	PITCH_ELEVATOR float32 ///< Control output -1 .. 1
	YAW_RUDDER     float32 ///< Control output -1 .. 1
	THROTTLE       float32 ///< Throttle 0 .. 1
	AUX1           float32 ///< Aux 1, -1 .. 1
	AUX2           float32 ///< Aux 2, -1 .. 1
	AUX3           float32 ///< Aux 3, -1 .. 1
	AUX4           float32 ///< Aux 4, -1 .. 1
	MODE           uint8   ///< System mode (MAV_MODE)
	NAV_MODE       uint8   ///< Navigation mode (MAV_NAV_MODE)
}

func (*HilControls) Crc

func (*HilControls) Crc() uint8

func (*HilControls) Decode

func (m *HilControls) Decode(buf []byte)

func (*HilControls) Id

func (*HilControls) Id() uint8

func (*HilControls) Len

func (*HilControls) Len() uint8

func (*HilControls) Pack

func (m *HilControls) Pack() []byte

type HilGps

type HilGps struct {
	TIME_USEC          uint64 ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	LAT                int32  ///< Latitude (WGS84), in degrees * 1E7
	LON                int32  ///< Longitude (WGS84), in degrees * 1E7
	ALT                int32  ///< Altitude (WGS84), in meters * 1000 (positive for up)
	EPH                uint16 ///< GPS HDOP horizontal dilution of position in cm (m*100). If unknown, set to: 65535
	EPV                uint16 ///< GPS VDOP vertical dilution of position in cm (m*100). If unknown, set to: 65535
	VEL                uint16 ///< GPS ground speed (m/s * 100). If unknown, set to: 65535
	VN                 int16  ///< GPS velocity in cm/s in NORTH direction in earth-fixed NED frame
	VE                 int16  ///< GPS velocity in cm/s in EAST direction in earth-fixed NED frame
	VD                 int16  ///< GPS velocity in cm/s in DOWN direction in earth-fixed NED frame
	COG                uint16 ///< Course over ground (NOT heading, but direction of movement) in degrees * 100, 0.0..359.99 degrees. If unknown, set to: 65535
	FIX_TYPE           uint8  ///< 0-1: no fix, 2: 2D fix, 3: 3D fix. Some applications will not use the value of this field unless it is at least two, so always correctly fill in the fix.
	SATELLITES_VISIBLE uint8  ///< Number of satellites visible. If unknown, set to 255
}

func (*HilGps) Crc

func (*HilGps) Crc() uint8

func (*HilGps) Decode

func (m *HilGps) Decode(buf []byte)

func (*HilGps) Id

func (*HilGps) Id() uint8

func (*HilGps) Len

func (*HilGps) Len() uint8

func (*HilGps) Pack

func (m *HilGps) Pack() []byte

type HilOpticalFlow

type HilOpticalFlow struct {
	TIME_USEC       uint64  ///< Timestamp (UNIX)
	FLOW_COMP_M_X   float32 ///< Flow in meters in x-sensor direction, angular-speed compensated
	FLOW_COMP_M_Y   float32 ///< Flow in meters in y-sensor direction, angular-speed compensated
	GROUND_DISTANCE float32 ///< Ground distance in meters. Positive value: distance known. Negative value: Unknown distance
	FLOW_X          int16   ///< Flow in pixels in x-sensor direction
	FLOW_Y          int16   ///< Flow in pixels in y-sensor direction
	SENSOR_ID       uint8   ///< Sensor ID
	QUALITY         uint8   ///< Optical flow quality / confidence. 0: bad, 255: maximum quality
}

func (*HilOpticalFlow) Crc

func (*HilOpticalFlow) Crc() uint8

func (*HilOpticalFlow) Decode

func (m *HilOpticalFlow) Decode(buf []byte)

func (*HilOpticalFlow) Id

func (*HilOpticalFlow) Id() uint8

func (*HilOpticalFlow) Len

func (*HilOpticalFlow) Len() uint8

func (*HilOpticalFlow) Pack

func (m *HilOpticalFlow) Pack() []byte

type HilRcInputsRaw

type HilRcInputsRaw struct {
	TIME_USEC  uint64 ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	CHAN1_RAW  uint16 ///< RC channel 1 value, in microseconds
	CHAN2_RAW  uint16 ///< RC channel 2 value, in microseconds
	CHAN3_RAW  uint16 ///< RC channel 3 value, in microseconds
	CHAN4_RAW  uint16 ///< RC channel 4 value, in microseconds
	CHAN5_RAW  uint16 ///< RC channel 5 value, in microseconds
	CHAN6_RAW  uint16 ///< RC channel 6 value, in microseconds
	CHAN7_RAW  uint16 ///< RC channel 7 value, in microseconds
	CHAN8_RAW  uint16 ///< RC channel 8 value, in microseconds
	CHAN9_RAW  uint16 ///< RC channel 9 value, in microseconds
	CHAN10_RAW uint16 ///< RC channel 10 value, in microseconds
	CHAN11_RAW uint16 ///< RC channel 11 value, in microseconds
	CHAN12_RAW uint16 ///< RC channel 12 value, in microseconds
	RSSI       uint8  ///< Receive signal strength indicator, 0: 0%, 255: 100%
}

func (*HilRcInputsRaw) Crc

func (*HilRcInputsRaw) Crc() uint8

func (*HilRcInputsRaw) Decode

func (m *HilRcInputsRaw) Decode(buf []byte)

func (*HilRcInputsRaw) Id

func (*HilRcInputsRaw) Id() uint8

func (*HilRcInputsRaw) Len

func (*HilRcInputsRaw) Len() uint8

func (*HilRcInputsRaw) Pack

func (m *HilRcInputsRaw) Pack() []byte

type HilSensor

type HilSensor struct {
	TIME_USEC      uint64  ///< Timestamp (microseconds, synced to UNIX time or since system boot)
	XACC           float32 ///< X acceleration (m/s^2)
	YACC           float32 ///< Y acceleration (m/s^2)
	ZACC           float32 ///< Z acceleration (m/s^2)
	XGYRO          float32 ///< Angular speed around X axis in body frame (rad / sec)
	YGYRO          float32 ///< Angular speed around Y axis in body frame (rad / sec)
	ZGYRO          float32 ///< Angular speed around Z axis in body frame (rad / sec)
	XMAG           float32 ///< X Magnetic field (Gauss)
	YMAG           float32 ///< Y Magnetic field (Gauss)
	ZMAG           float32 ///< Z Magnetic field (Gauss)
	ABS_PRESSURE   float32 ///< Absolute pressure in millibar
	DIFF_PRESSURE  float32 ///< Differential pressure (airspeed) in millibar
	PRESSURE_ALT   float32 ///< Altitude calculated from pressure
	TEMPERATURE    float32 ///< Temperature in degrees celsius
	FIELDS_UPDATED uint32  ///< Bitmask for fields that have updated since last message, bit 0 = xacc, bit 12: temperature
}

func (*HilSensor) Crc

func (*HilSensor) Crc() uint8

func (*HilSensor) Decode

func (m *HilSensor) Decode(buf []byte)

func (*HilSensor) Id

func (*HilSensor) Id() uint8

func (*HilSensor) Len

func (*HilSensor) Len() uint8

func (*HilSensor) Pack

func (m *HilSensor) Pack() []byte

type HilState

type HilState struct {
	TIME_USEC  uint64  ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	ROLL       float32 ///< Roll angle (rad)
	PITCH      float32 ///< Pitch angle (rad)
	YAW        float32 ///< Yaw angle (rad)
	ROLLSPEED  float32 ///< Body frame roll / phi angular speed (rad/s)
	PITCHSPEED float32 ///< Body frame pitch / theta angular speed (rad/s)
	YAWSPEED   float32 ///< Body frame yaw / psi angular speed (rad/s)
	LAT        int32   ///< Latitude, expressed as * 1E7
	LON        int32   ///< Longitude, expressed as * 1E7
	ALT        int32   ///< Altitude in meters, expressed as * 1000 (millimeters)
	VX         int16   ///< Ground X Speed (Latitude), expressed as m/s * 100
	VY         int16   ///< Ground Y Speed (Longitude), expressed as m/s * 100
	VZ         int16   ///< Ground Z Speed (Altitude), expressed as m/s * 100
	XACC       int16   ///< X acceleration (mg)
	YACC       int16   ///< Y acceleration (mg)
	ZACC       int16   ///< Z acceleration (mg)
}

func (*HilState) Crc

func (*HilState) Crc() uint8

func (*HilState) Decode

func (m *HilState) Decode(buf []byte)

func (*HilState) Id

func (*HilState) Id() uint8

func (*HilState) Len

func (*HilState) Len() uint8

func (*HilState) Pack

func (m *HilState) Pack() []byte

type HilStateQuaternion

type HilStateQuaternion struct {
	TIME_USEC           uint64     ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	ATTITUDE_QUATERNION [4]float32 ///< Vehicle attitude expressed as normalized quaternion in w, x, y, z order (with 1 0 0 0 being the null-rotation)
	ROLLSPEED           float32    ///< Body frame roll / phi angular speed (rad/s)
	PITCHSPEED          float32    ///< Body frame pitch / theta angular speed (rad/s)
	YAWSPEED            float32    ///< Body frame yaw / psi angular speed (rad/s)
	LAT                 int32      ///< Latitude, expressed as * 1E7
	LON                 int32      ///< Longitude, expressed as * 1E7
	ALT                 int32      ///< Altitude in meters, expressed as * 1000 (millimeters)
	VX                  int16      ///< Ground X Speed (Latitude), expressed as m/s * 100
	VY                  int16      ///< Ground Y Speed (Longitude), expressed as m/s * 100
	VZ                  int16      ///< Ground Z Speed (Altitude), expressed as m/s * 100
	IND_AIRSPEED        uint16     ///< Indicated airspeed, expressed as m/s * 100
	TRUE_AIRSPEED       uint16     ///< True airspeed, expressed as m/s * 100
	XACC                int16      ///< X acceleration (mg)
	YACC                int16      ///< Y acceleration (mg)
	ZACC                int16      ///< Z acceleration (mg)
}

func (*HilStateQuaternion) Crc

func (*HilStateQuaternion) Crc() uint8

func (*HilStateQuaternion) Decode

func (m *HilStateQuaternion) Decode(buf []byte)

func (*HilStateQuaternion) Id

func (*HilStateQuaternion) Id() uint8

func (*HilStateQuaternion) Len

func (*HilStateQuaternion) Len() uint8

func (*HilStateQuaternion) Pack

func (m *HilStateQuaternion) Pack() []byte

type LocalNedPositionSetpointExternal

type LocalNedPositionSetpointExternal struct {
	TIME_BOOT_MS     uint32  ///< Timestamp in milliseconds since system boot
	X                float32 ///< X Position in NED frame in meters
	Y                float32 ///< Y Position in NED frame in meters
	Z                float32 ///< Z Position in NED frame in meters (note, altitude is negative in NED)
	VX               float32 ///< X velocity in NED frame in meter / s
	VY               float32 ///< Y velocity in NED frame in meter / s
	VZ               float32 ///< Z velocity in NED frame in meter / s
	AFX              float32 ///< X acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N
	AFY              float32 ///< Y acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N
	AFZ              float32 ///< Z acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N
	TYPE_MASK        uint16  ///< Bitmask to indicate which dimensions should be ignored by the vehicle: a value of 0b0000000000000000 or 0b0000001000000000 indicates that none of the setpoint dimensions should be ignored. If bit 10 is set the floats afx afy afz should be interpreted as force instead of acceleration. Mapping: bit 1: x, bit 2: y, bit 3: z, bit 4: vx, bit 5: vy, bit 6: vz, bit 7: ax, bit 8: ay, bit 9: az, bit 10: is force setpoint
	TARGET_SYSTEM    uint8   ///< System ID
	TARGET_COMPONENT uint8   ///< Component ID
	COORDINATE_FRAME uint8   ///< Valid options are: MAV_FRAME_LOCAL_NED, MAV_FRAME_LOCAL_OFFSET_NED = 5, MAV_FRAME_BODY_NED = 6, MAV_FRAME_BODY_OFFSET_NED = 7
}

func (*LocalNedPositionSetpointExternal) Crc

func (*LocalNedPositionSetpointExternal) Decode

func (m *LocalNedPositionSetpointExternal) Decode(buf []byte)

func (*LocalNedPositionSetpointExternal) Id

func (*LocalNedPositionSetpointExternal) Len

func (*LocalNedPositionSetpointExternal) Pack

type LocalPositionNed

type LocalPositionNed struct {
	TIME_BOOT_MS uint32  ///< Timestamp (milliseconds since system boot)
	X            float32 ///< X Position
	Y            float32 ///< Y Position
	Z            float32 ///< Z Position
	VX           float32 ///< X Speed
	VY           float32 ///< Y Speed
	VZ           float32 ///< Z Speed
}

func (*LocalPositionNed) Crc

func (*LocalPositionNed) Crc() uint8

func (*LocalPositionNed) Decode

func (m *LocalPositionNed) Decode(buf []byte)

func (*LocalPositionNed) Id

func (*LocalPositionNed) Id() uint8

func (*LocalPositionNed) Len

func (*LocalPositionNed) Len() uint8

func (*LocalPositionNed) Pack

func (m *LocalPositionNed) Pack() []byte

type LocalPositionNedSystemGlobalOffset

type LocalPositionNedSystemGlobalOffset struct {
	TIME_BOOT_MS uint32  ///< Timestamp (milliseconds since system boot)
	X            float32 ///< X Position
	Y            float32 ///< Y Position
	Z            float32 ///< Z Position
	ROLL         float32 ///< Roll
	PITCH        float32 ///< Pitch
	YAW          float32 ///< Yaw
}

func (*LocalPositionNedSystemGlobalOffset) Crc

func (*LocalPositionNedSystemGlobalOffset) Decode

func (m *LocalPositionNedSystemGlobalOffset) Decode(buf []byte)

func (*LocalPositionNedSystemGlobalOffset) Id

func (*LocalPositionNedSystemGlobalOffset) Len

func (*LocalPositionNedSystemGlobalOffset) Pack

type LocalPositionSetpoint

type LocalPositionSetpoint struct {
	X                float32 ///< x position
	Y                float32 ///< y position
	Z                float32 ///< z position
	YAW              float32 ///< Desired yaw angle
	COORDINATE_FRAME uint8   ///< Coordinate frame - valid values are only MAV_FRAME_LOCAL_NED or MAV_FRAME_LOCAL_ENU
}

func (*LocalPositionSetpoint) Crc

func (*LocalPositionSetpoint) Decode

func (m *LocalPositionSetpoint) Decode(buf []byte)

func (*LocalPositionSetpoint) Id

func (*LocalPositionSetpoint) Len

func (*LocalPositionSetpoint) Pack

func (m *LocalPositionSetpoint) Pack() []byte

type LogData

type LogData struct {
	OFS   uint32    ///< Offset into the log
	ID    uint16    ///< Log id (from LOG_ENTRY reply)
	COUNT uint8     ///< Number of bytes (zero for end of log)
	DATA  [90]uint8 ///< log data
}

func (*LogData) Crc

func (*LogData) Crc() uint8

func (*LogData) Decode

func (m *LogData) Decode(buf []byte)

func (*LogData) Id

func (*LogData) Id() uint8

func (*LogData) Len

func (*LogData) Len() uint8

func (*LogData) Pack

func (m *LogData) Pack() []byte

type LogEntry

type LogEntry struct {
	TIME_UTC     uint32 ///< UTC timestamp of log in seconds since 1970, or 0 if not available
	SIZE         uint32 ///< Size of the log (may be approximate) in bytes
	ID           uint16 ///< Log id
	NUM_LOGS     uint16 ///< Total number of logs
	LAST_LOG_NUM uint16 ///< High log number
}

func (*LogEntry) Crc

func (*LogEntry) Crc() uint8

func (*LogEntry) Decode

func (m *LogEntry) Decode(buf []byte)

func (*LogEntry) Id

func (*LogEntry) Id() uint8

func (*LogEntry) Len

func (*LogEntry) Len() uint8

func (*LogEntry) Pack

func (m *LogEntry) Pack() []byte

type LogErase

type LogErase struct {
	TARGET_SYSTEM    uint8 ///< System ID
	TARGET_COMPONENT uint8 ///< Component ID
}

func (*LogErase) Crc

func (*LogErase) Crc() uint8

func (*LogErase) Decode

func (m *LogErase) Decode(buf []byte)

func (*LogErase) Id

func (*LogErase) Id() uint8

func (*LogErase) Len

func (*LogErase) Len() uint8

func (*LogErase) Pack

func (m *LogErase) Pack() []byte

type LogRequestData

type LogRequestData struct {
	OFS              uint32 ///< Offset into the log
	COUNT            uint32 ///< Number of bytes
	ID               uint16 ///< Log id (from LOG_ENTRY reply)
	TARGET_SYSTEM    uint8  ///< System ID
	TARGET_COMPONENT uint8  ///< Component ID
}

func (*LogRequestData) Crc

func (*LogRequestData) Crc() uint8

func (*LogRequestData) Decode

func (m *LogRequestData) Decode(buf []byte)

func (*LogRequestData) Id

func (*LogRequestData) Id() uint8

func (*LogRequestData) Len

func (*LogRequestData) Len() uint8

func (*LogRequestData) Pack

func (m *LogRequestData) Pack() []byte

type LogRequestEnd

type LogRequestEnd struct {
	TARGET_SYSTEM    uint8 ///< System ID
	TARGET_COMPONENT uint8 ///< Component ID
}

func (*LogRequestEnd) Crc

func (*LogRequestEnd) Crc() uint8

func (*LogRequestEnd) Decode

func (m *LogRequestEnd) Decode(buf []byte)

func (*LogRequestEnd) Id

func (*LogRequestEnd) Id() uint8

func (*LogRequestEnd) Len

func (*LogRequestEnd) Len() uint8

func (*LogRequestEnd) Pack

func (m *LogRequestEnd) Pack() []byte

type LogRequestList

type LogRequestList struct {
	START            uint16 ///< First log id (0 for first available)
	END              uint16 ///< Last log id (0xffff for last available)
	TARGET_SYSTEM    uint8  ///< System ID
	TARGET_COMPONENT uint8  ///< Component ID
}

func (*LogRequestList) Crc

func (*LogRequestList) Crc() uint8

func (*LogRequestList) Decode

func (m *LogRequestList) Decode(buf []byte)

func (*LogRequestList) Id

func (*LogRequestList) Id() uint8

func (*LogRequestList) Len

func (*LogRequestList) Len() uint8

func (*LogRequestList) Pack

func (m *LogRequestList) Pack() []byte

type MAVLinkMessage

type MAVLinkMessage interface {
	Id() uint8
	Len() uint8
	Crc() uint8
	Pack() []byte
	Decode([]byte)
}

func NewAttitude

func NewAttitude(TIME_BOOT_MS uint32, ROLL float32, PITCH float32, YAW float32, ROLLSPEED float32, PITCHSPEED float32, YAWSPEED float32) MAVLinkMessage

func NewAttitudeQuaternion

func NewAttitudeQuaternion(TIME_BOOT_MS uint32, Q1 float32, Q2 float32, Q3 float32, Q4 float32, ROLLSPEED float32, PITCHSPEED float32, YAWSPEED float32) MAVLinkMessage

func NewAttitudeSetpointExternal

func NewAttitudeSetpointExternal(TIME_BOOT_MS uint32, Q [4]float32, BODY_ROLL_RATE float32, BODY_PITCH_RATE float32, BODY_YAW_RATE float32, THRUST float32, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, TYPE_MASK uint8) MAVLinkMessage

func NewAuthKey

func NewAuthKey(KEY [32]uint8) MAVLinkMessage

func NewBatteryStatus

func NewBatteryStatus(CURRENT_CONSUMED int32, ENERGY_CONSUMED int32, VOLTAGE_CELL_1 uint16, VOLTAGE_CELL_2 uint16, VOLTAGE_CELL_3 uint16, VOLTAGE_CELL_4 uint16, VOLTAGE_CELL_5 uint16, VOLTAGE_CELL_6 uint16, CURRENT_BATTERY int16, ACCU_ID uint8, BATTERY_REMAINING int8) MAVLinkMessage

func NewChangeOperatorControl

func NewChangeOperatorControl(TARGET_SYSTEM uint8, CONTROL_REQUEST uint8, VERSION uint8, PASSKEY [25]uint8) MAVLinkMessage

func NewChangeOperatorControlAck

func NewChangeOperatorControlAck(GCS_SYSTEM_ID uint8, CONTROL_REQUEST uint8, ACK uint8) MAVLinkMessage

func NewCommandAck

func NewCommandAck(COMMAND uint16, RESULT uint8) MAVLinkMessage

func NewCommandLong

func NewCommandLong(PARAM1 float32, PARAM2 float32, PARAM3 float32, PARAM4 float32, PARAM5 float32, PARAM6 float32, PARAM7 float32, COMMAND uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, CONFIRMATION uint8) MAVLinkMessage

func NewDataStream

func NewDataStream(MESSAGE_RATE uint16, STREAM_ID uint8, ON_OFF uint8) MAVLinkMessage

func NewDataTransmissionHandshake

func NewDataTransmissionHandshake(SIZE uint32, WIDTH uint16, HEIGHT uint16, PACKETS uint16, TYPE uint8, PAYLOAD uint8, JPG_QUALITY uint8) MAVLinkMessage

func NewDebug

func NewDebug(TIME_BOOT_MS uint32, VALUE float32, IND uint8) MAVLinkMessage

func NewDebugVect

func NewDebugVect(TIME_USEC uint64, X float32, Y float32, Z float32, NAME [10]uint8) MAVLinkMessage

func NewDistanceSensor

func NewDistanceSensor(TIME_BOOT_MS uint32, MIN_DISTANCE uint16, MAX_DISTANCE uint16, CURRENT_DISTANCE uint16, TYPE uint8, ID uint8, ORIENTATION uint8, COVARIANCE uint8) MAVLinkMessage

func NewEncapsulatedData

func NewEncapsulatedData(SEQNR uint16, DATA [253]uint8) MAVLinkMessage

func NewFileTransferDirList

func NewFileTransferDirList(TRANSFER_UID uint64, DIR_PATH [240]uint8, FLAGS uint8) MAVLinkMessage

func NewFileTransferRes

func NewFileTransferRes(TRANSFER_UID uint64, RESULT uint8) MAVLinkMessage

func NewFileTransferStart

func NewFileTransferStart(TRANSFER_UID uint64, FILE_SIZE uint32, DEST_PATH [240]uint8, DIRECTION uint8, FLAGS uint8) MAVLinkMessage

func NewGlobalPositionInt

func NewGlobalPositionInt(TIME_BOOT_MS uint32, LAT int32, LON int32, ALT int32, RELATIVE_ALT int32, VX int16, VY int16, VZ int16, HDG uint16) MAVLinkMessage

func NewGlobalPositionSetpointExternalInt

func NewGlobalPositionSetpointExternalInt(TIME_BOOT_MS uint32, LAT_INT int32, LON_INT int32, ALT float32, VX float32, VY float32, VZ float32, AFX float32, AFY float32, AFZ float32, TYPE_MASK uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewGlobalPositionSetpointInt

func NewGlobalPositionSetpointInt(LATITUDE int32, LONGITUDE int32, ALTITUDE int32, YAW int16, COORDINATE_FRAME uint8) MAVLinkMessage

func NewGlobalVisionPositionEstimate

func NewGlobalVisionPositionEstimate(USEC uint64, X float32, Y float32, Z float32, ROLL float32, PITCH float32, YAW float32) MAVLinkMessage

func NewGps2Raw

func NewGps2Raw(TIME_USEC uint64, LAT int32, LON int32, ALT int32, DGPS_AGE uint32, EPH uint16, EPV uint16, VEL uint16, COG uint16, FIX_TYPE uint8, SATELLITES_VISIBLE uint8, DGPS_NUMCH uint8) MAVLinkMessage

func NewGps2Rtk

func NewGps2Rtk(TIME_LAST_BASELINE_MS uint32, TOW uint32, BASELINE_A_MM int32, BASELINE_B_MM int32, BASELINE_C_MM int32, ACCURACY uint32, IAR_NUM_HYPOTHESES int32, WN uint16, RTK_RECEIVER_ID uint8, RTK_HEALTH uint8, RTK_RATE uint8, NSATS uint8, BASELINE_COORDS_TYPE uint8) MAVLinkMessage

func NewGpsGlobalOrigin

func NewGpsGlobalOrigin(LATITUDE int32, LONGITUDE int32, ALTITUDE int32) MAVLinkMessage

func NewGpsInjectData

func NewGpsInjectData(TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, LEN uint8, DATA [110]uint8) MAVLinkMessage

func NewGpsRawInt

func NewGpsRawInt(TIME_USEC uint64, LAT int32, LON int32, ALT int32, EPH uint16, EPV uint16, VEL uint16, COG uint16, FIX_TYPE uint8, SATELLITES_VISIBLE uint8) MAVLinkMessage

func NewGpsRtk

func NewGpsRtk(TIME_LAST_BASELINE_MS uint32, TOW uint32, BASELINE_A_MM int32, BASELINE_B_MM int32, BASELINE_C_MM int32, ACCURACY uint32, IAR_NUM_HYPOTHESES int32, WN uint16, RTK_RECEIVER_ID uint8, RTK_HEALTH uint8, RTK_RATE uint8, NSATS uint8, BASELINE_COORDS_TYPE uint8) MAVLinkMessage

func NewGpsStatus

func NewGpsStatus(SATELLITES_VISIBLE uint8, SATELLITE_PRN [20]uint8, SATELLITE_USED [20]uint8, SATELLITE_ELEVATION [20]uint8, SATELLITE_AZIMUTH [20]uint8, SATELLITE_SNR [20]uint8) MAVLinkMessage

func NewHeartbeat

func NewHeartbeat(CUSTOM_MODE uint32, TYPE uint8, AUTOPILOT uint8, BASE_MODE uint8, SYSTEM_STATUS uint8, MAVLINK_VERSION uint8) MAVLinkMessage

func NewHighresImu

func NewHighresImu(TIME_USEC uint64, XACC float32, YACC float32, ZACC float32, XGYRO float32, YGYRO float32, ZGYRO float32, XMAG float32, YMAG float32, ZMAG float32, ABS_PRESSURE float32, DIFF_PRESSURE float32, PRESSURE_ALT float32, TEMPERATURE float32, FIELDS_UPDATED uint16) MAVLinkMessage

func NewHilControls

func NewHilControls(TIME_USEC uint64, ROLL_AILERONS float32, PITCH_ELEVATOR float32, YAW_RUDDER float32, THROTTLE float32, AUX1 float32, AUX2 float32, AUX3 float32, AUX4 float32, MODE uint8, NAV_MODE uint8) MAVLinkMessage

func NewHilGps

func NewHilGps(TIME_USEC uint64, LAT int32, LON int32, ALT int32, EPH uint16, EPV uint16, VEL uint16, VN int16, VE int16, VD int16, COG uint16, FIX_TYPE uint8, SATELLITES_VISIBLE uint8) MAVLinkMessage

func NewHilOpticalFlow

func NewHilOpticalFlow(TIME_USEC uint64, FLOW_COMP_M_X float32, FLOW_COMP_M_Y float32, GROUND_DISTANCE float32, FLOW_X int16, FLOW_Y int16, SENSOR_ID uint8, QUALITY uint8) MAVLinkMessage

func NewHilRcInputsRaw

func NewHilRcInputsRaw(TIME_USEC uint64, CHAN1_RAW uint16, CHAN2_RAW uint16, CHAN3_RAW uint16, CHAN4_RAW uint16, CHAN5_RAW uint16, CHAN6_RAW uint16, CHAN7_RAW uint16, CHAN8_RAW uint16, CHAN9_RAW uint16, CHAN10_RAW uint16, CHAN11_RAW uint16, CHAN12_RAW uint16, RSSI uint8) MAVLinkMessage

func NewHilSensor

func NewHilSensor(TIME_USEC uint64, XACC float32, YACC float32, ZACC float32, XGYRO float32, YGYRO float32, ZGYRO float32, XMAG float32, YMAG float32, ZMAG float32, ABS_PRESSURE float32, DIFF_PRESSURE float32, PRESSURE_ALT float32, TEMPERATURE float32, FIELDS_UPDATED uint32) MAVLinkMessage

func NewHilState

func NewHilState(TIME_USEC uint64, ROLL float32, PITCH float32, YAW float32, ROLLSPEED float32, PITCHSPEED float32, YAWSPEED float32, LAT int32, LON int32, ALT int32, VX int16, VY int16, VZ int16, XACC int16, YACC int16, ZACC int16) MAVLinkMessage

func NewHilStateQuaternion

func NewHilStateQuaternion(TIME_USEC uint64, ATTITUDE_QUATERNION [4]float32, ROLLSPEED float32, PITCHSPEED float32, YAWSPEED float32, LAT int32, LON int32, ALT int32, VX int16, VY int16, VZ int16, IND_AIRSPEED uint16, TRUE_AIRSPEED uint16, XACC int16, YACC int16, ZACC int16) MAVLinkMessage

func NewLocalNedPositionSetpointExternal

func NewLocalNedPositionSetpointExternal(TIME_BOOT_MS uint32, X float32, Y float32, Z float32, VX float32, VY float32, VZ float32, AFX float32, AFY float32, AFZ float32, TYPE_MASK uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, COORDINATE_FRAME uint8) MAVLinkMessage

func NewLocalPositionNed

func NewLocalPositionNed(TIME_BOOT_MS uint32, X float32, Y float32, Z float32, VX float32, VY float32, VZ float32) MAVLinkMessage

func NewLocalPositionNedSystemGlobalOffset

func NewLocalPositionNedSystemGlobalOffset(TIME_BOOT_MS uint32, X float32, Y float32, Z float32, ROLL float32, PITCH float32, YAW float32) MAVLinkMessage

func NewLocalPositionSetpoint

func NewLocalPositionSetpoint(X float32, Y float32, Z float32, YAW float32, COORDINATE_FRAME uint8) MAVLinkMessage

func NewLogData

func NewLogData(OFS uint32, ID uint16, COUNT uint8, DATA [90]uint8) MAVLinkMessage

func NewLogEntry

func NewLogEntry(TIME_UTC uint32, SIZE uint32, ID uint16, NUM_LOGS uint16, LAST_LOG_NUM uint16) MAVLinkMessage

func NewLogErase

func NewLogErase(TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewLogRequestData

func NewLogRequestData(OFS uint32, COUNT uint32, ID uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewLogRequestEnd

func NewLogRequestEnd(TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewLogRequestList

func NewLogRequestList(START uint16, END uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewMAVLinkMessage

func NewMAVLinkMessage(msgid uint8, data []byte) (MAVLinkMessage, error)

func NewManualControl

func NewManualControl(X int16, Y int16, Z int16, R int16, BUTTONS uint16, TARGET uint8) MAVLinkMessage

func NewManualSetpoint

func NewManualSetpoint(TIME_BOOT_MS uint32, ROLL float32, PITCH float32, YAW float32, THRUST float32, MODE_SWITCH uint8, MANUAL_OVERRIDE_SWITCH uint8) MAVLinkMessage

func NewMemoryVect

func NewMemoryVect(ADDRESS uint16, VER uint8, TYPE uint8, VALUE [32]int8) MAVLinkMessage

func NewMissionAck

func NewMissionAck(TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, TYPE uint8) MAVLinkMessage

func NewMissionClearAll

func NewMissionClearAll(TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewMissionCount

func NewMissionCount(COUNT uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewMissionCurrent

func NewMissionCurrent(SEQ uint16) MAVLinkMessage

func NewMissionItem

func NewMissionItem(PARAM1 float32, PARAM2 float32, PARAM3 float32, PARAM4 float32, X float32, Y float32, Z float32, SEQ uint16, COMMAND uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, FRAME uint8, CURRENT uint8, AUTOCONTINUE uint8) MAVLinkMessage

func NewMissionItemReached

func NewMissionItemReached(SEQ uint16) MAVLinkMessage

func NewMissionRequest

func NewMissionRequest(SEQ uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewMissionRequestList

func NewMissionRequestList(TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewMissionRequestPartialList

func NewMissionRequestPartialList(START_INDEX int16, END_INDEX int16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewMissionSetCurrent

func NewMissionSetCurrent(SEQ uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewMissionWritePartialList

func NewMissionWritePartialList(START_INDEX int16, END_INDEX int16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewNamedValueFloat

func NewNamedValueFloat(TIME_BOOT_MS uint32, VALUE float32, NAME [10]uint8) MAVLinkMessage

func NewNamedValueInt

func NewNamedValueInt(TIME_BOOT_MS uint32, VALUE int32, NAME [10]uint8) MAVLinkMessage

func NewNavControllerOutput

func NewNavControllerOutput(NAV_ROLL float32, NAV_PITCH float32, ALT_ERROR float32, ASPD_ERROR float32, XTRACK_ERROR float32, NAV_BEARING int16, TARGET_BEARING int16, WP_DIST uint16) MAVLinkMessage

func NewOmnidirectionalFlow

func NewOmnidirectionalFlow(TIME_USEC uint64, FRONT_DISTANCE_M float32, LEFT [10]int16, RIGHT [10]int16, SENSOR_ID uint8, QUALITY uint8) MAVLinkMessage

func NewOpticalFlow

func NewOpticalFlow(TIME_USEC uint64, FLOW_COMP_M_X float32, FLOW_COMP_M_Y float32, GROUND_DISTANCE float32, FLOW_X int16, FLOW_Y int16, SENSOR_ID uint8, QUALITY uint8) MAVLinkMessage

func NewParamRequestList

func NewParamRequestList(TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewParamRequestRead

func NewParamRequestRead(PARAM_INDEX int16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, PARAM_ID [16]uint8) MAVLinkMessage

func NewParamSet

func NewParamSet(PARAM_VALUE float32, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, PARAM_ID [16]uint8, PARAM_TYPE uint8) MAVLinkMessage

func NewParamValue

func NewParamValue(PARAM_VALUE float32, PARAM_COUNT uint16, PARAM_INDEX uint16, PARAM_ID [16]uint8, PARAM_TYPE uint8) MAVLinkMessage

func NewPing

func NewPing(TIME_USEC uint64, SEQ uint32, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewPowerStatus

func NewPowerStatus(VCC uint16, VSERVO uint16, FLAGS uint16) MAVLinkMessage

func NewRadioStatus

func NewRadioStatus(RXERRORS uint16, FIXED uint16, RSSI uint8, REMRSSI uint8, TXBUF uint8, NOISE uint8, REMNOISE uint8) MAVLinkMessage

func NewRawImu

func NewRawImu(TIME_USEC uint64, XACC int16, YACC int16, ZACC int16, XGYRO int16, YGYRO int16, ZGYRO int16, XMAG int16, YMAG int16, ZMAG int16) MAVLinkMessage

func NewRawPressure

func NewRawPressure(TIME_USEC uint64, PRESS_ABS int16, PRESS_DIFF1 int16, PRESS_DIFF2 int16, TEMPERATURE int16) MAVLinkMessage

func NewRcChannels

func NewRcChannels(TIME_BOOT_MS uint32, CHAN1_RAW uint16, CHAN2_RAW uint16, CHAN3_RAW uint16, CHAN4_RAW uint16, CHAN5_RAW uint16, CHAN6_RAW uint16, CHAN7_RAW uint16, CHAN8_RAW uint16, CHAN9_RAW uint16, CHAN10_RAW uint16, CHAN11_RAW uint16, CHAN12_RAW uint16, CHAN13_RAW uint16, CHAN14_RAW uint16, CHAN15_RAW uint16, CHAN16_RAW uint16, CHAN17_RAW uint16, CHAN18_RAW uint16, CHANCOUNT uint8, RSSI uint8) MAVLinkMessage

func NewRcChannelsOverride

func NewRcChannelsOverride(CHAN1_RAW uint16, CHAN2_RAW uint16, CHAN3_RAW uint16, CHAN4_RAW uint16, CHAN5_RAW uint16, CHAN6_RAW uint16, CHAN7_RAW uint16, CHAN8_RAW uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewRcChannelsRaw

func NewRcChannelsRaw(TIME_BOOT_MS uint32, CHAN1_RAW uint16, CHAN2_RAW uint16, CHAN3_RAW uint16, CHAN4_RAW uint16, CHAN5_RAW uint16, CHAN6_RAW uint16, CHAN7_RAW uint16, CHAN8_RAW uint16, PORT uint8, RSSI uint8) MAVLinkMessage

func NewRcChannelsScaled

func NewRcChannelsScaled(TIME_BOOT_MS uint32, CHAN1_SCALED int16, CHAN2_SCALED int16, CHAN3_SCALED int16, CHAN4_SCALED int16, CHAN5_SCALED int16, CHAN6_SCALED int16, CHAN7_SCALED int16, CHAN8_SCALED int16, PORT uint8, RSSI uint8) MAVLinkMessage

func NewRequestDataStream

func NewRequestDataStream(REQ_MESSAGE_RATE uint16, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, REQ_STREAM_ID uint8, START_STOP uint8) MAVLinkMessage

func NewRollPitchYawRatesThrustSetpoint

func NewRollPitchYawRatesThrustSetpoint(TIME_BOOT_MS uint32, ROLL_RATE float32, PITCH_RATE float32, YAW_RATE float32, THRUST float32) MAVLinkMessage

func NewRollPitchYawSpeedThrustSetpoint

func NewRollPitchYawSpeedThrustSetpoint(TIME_BOOT_MS uint32, ROLL_SPEED float32, PITCH_SPEED float32, YAW_SPEED float32, THRUST float32) MAVLinkMessage

func NewRollPitchYawThrustSetpoint

func NewRollPitchYawThrustSetpoint(TIME_BOOT_MS uint32, ROLL float32, PITCH float32, YAW float32, THRUST float32) MAVLinkMessage

func NewSafetyAllowedArea

func NewSafetyAllowedArea(P1X float32, P1Y float32, P1Z float32, P2X float32, P2Y float32, P2Z float32, FRAME uint8) MAVLinkMessage

func NewSafetySetAllowedArea

func NewSafetySetAllowedArea(P1X float32, P1Y float32, P1Z float32, P2X float32, P2Y float32, P2Z float32, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, FRAME uint8) MAVLinkMessage

func NewScaledImu

func NewScaledImu(TIME_BOOT_MS uint32, XACC int16, YACC int16, ZACC int16, XGYRO int16, YGYRO int16, ZGYRO int16, XMAG int16, YMAG int16, ZMAG int16) MAVLinkMessage

func NewScaledImu2

func NewScaledImu2(TIME_BOOT_MS uint32, XACC int16, YACC int16, ZACC int16, XGYRO int16, YGYRO int16, ZGYRO int16, XMAG int16, YMAG int16, ZMAG int16) MAVLinkMessage

func NewScaledPressure

func NewScaledPressure(TIME_BOOT_MS uint32, PRESS_ABS float32, PRESS_DIFF float32, TEMPERATURE int16) MAVLinkMessage

func NewSerialControl

func NewSerialControl(BAUDRATE uint32, TIMEOUT uint16, DEVICE uint8, FLAGS uint8, COUNT uint8, DATA [70]uint8) MAVLinkMessage

func NewServoOutputRaw

func NewServoOutputRaw(TIME_USEC uint32, SERVO1_RAW uint16, SERVO2_RAW uint16, SERVO3_RAW uint16, SERVO4_RAW uint16, SERVO5_RAW uint16, SERVO6_RAW uint16, SERVO7_RAW uint16, SERVO8_RAW uint16, PORT uint8) MAVLinkMessage

func NewSetGlobalPositionSetpointInt

func NewSetGlobalPositionSetpointInt(LATITUDE int32, LONGITUDE int32, ALTITUDE int32, YAW int16, COORDINATE_FRAME uint8) MAVLinkMessage

func NewSetGpsGlobalOrigin

func NewSetGpsGlobalOrigin(LATITUDE int32, LONGITUDE int32, ALTITUDE int32, TARGET_SYSTEM uint8) MAVLinkMessage

func NewSetLocalPositionSetpoint

func NewSetLocalPositionSetpoint(X float32, Y float32, Z float32, YAW float32, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8, COORDINATE_FRAME uint8) MAVLinkMessage

func NewSetMode

func NewSetMode(CUSTOM_MODE uint32, TARGET_SYSTEM uint8, BASE_MODE uint8) MAVLinkMessage

func NewSetQuadMotorsSetpoint

func NewSetQuadMotorsSetpoint(MOTOR_FRONT_NW uint16, MOTOR_RIGHT_NE uint16, MOTOR_BACK_SE uint16, MOTOR_LEFT_SW uint16, TARGET_SYSTEM uint8) MAVLinkMessage

func NewSetQuadSwarmLedRollPitchYawThrust

func NewSetQuadSwarmLedRollPitchYawThrust(ROLL [4]int16, PITCH [4]int16, YAW [4]int16, THRUST [4]uint16, GROUP uint8, MODE uint8, LED_RED [4]uint8, LED_BLUE [4]uint8, LED_GREEN [4]uint8) MAVLinkMessage

func NewSetQuadSwarmRollPitchYawThrust

func NewSetQuadSwarmRollPitchYawThrust(ROLL [4]int16, PITCH [4]int16, YAW [4]int16, THRUST [4]uint16, GROUP uint8, MODE uint8) MAVLinkMessage

func NewSetRollPitchYawSpeedThrust

func NewSetRollPitchYawSpeedThrust(ROLL_SPEED float32, PITCH_SPEED float32, YAW_SPEED float32, THRUST float32, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewSetRollPitchYawThrust

func NewSetRollPitchYawThrust(ROLL float32, PITCH float32, YAW float32, THRUST float32, TARGET_SYSTEM uint8, TARGET_COMPONENT uint8) MAVLinkMessage

func NewSetpoint6Dof

func NewSetpoint6Dof(TRANS_X float32, TRANS_Y float32, TRANS_Z float32, ROT_X float32, ROT_Y float32, ROT_Z float32, TARGET_SYSTEM uint8) MAVLinkMessage

func NewSetpoint8Dof

func NewSetpoint8Dof(VAL1 float32, VAL2 float32, VAL3 float32, VAL4 float32, VAL5 float32, VAL6 float32, VAL7 float32, VAL8 float32, TARGET_SYSTEM uint8) MAVLinkMessage

func NewSimState

func NewSimState(Q1 float32, Q2 float32, Q3 float32, Q4 float32, ROLL float32, PITCH float32, YAW float32, XACC float32, YACC float32, ZACC float32, XGYRO float32, YGYRO float32, ZGYRO float32, LAT float32, LON float32, ALT float32, STD_DEV_HORZ float32, STD_DEV_VERT float32, VN float32, VE float32, VD float32) MAVLinkMessage

func NewStateCorrection

func NewStateCorrection(XERR float32, YERR float32, ZERR float32, ROLLERR float32, PITCHERR float32, YAWERR float32, VXERR float32, VYERR float32, VZERR float32) MAVLinkMessage

func NewStatustext

func NewStatustext(SEVERITY uint8, TEXT [50]uint8) MAVLinkMessage

func NewSysStatus

func NewSysStatus(ONBOARD_CONTROL_SENSORS_PRESENT uint32, ONBOARD_CONTROL_SENSORS_ENABLED uint32, ONBOARD_CONTROL_SENSORS_HEALTH uint32, LOAD uint16, VOLTAGE_BATTERY uint16, CURRENT_BATTERY int16, DROP_RATE_COMM uint16, ERRORS_COMM uint16, ERRORS_COUNT1 uint16, ERRORS_COUNT2 uint16, ERRORS_COUNT3 uint16, ERRORS_COUNT4 uint16, BATTERY_REMAINING int8) MAVLinkMessage

func NewSystemTime

func NewSystemTime(TIME_UNIX_USEC uint64, TIME_BOOT_MS uint32) MAVLinkMessage

func NewTerrainCheck

func NewTerrainCheck(LAT int32, LON int32) MAVLinkMessage

func NewTerrainData

func NewTerrainData(LAT int32, LON int32, GRID_SPACING uint16, DATA [16]int16, GRIDBIT uint8) MAVLinkMessage

func NewTerrainReport

func NewTerrainReport(LAT int32, LON int32, TERRAIN_HEIGHT float32, CURRENT_HEIGHT float32, SPACING uint16, PENDING uint16, LOADED uint16) MAVLinkMessage

func NewTerrainRequest

func NewTerrainRequest(MASK uint64, LAT int32, LON int32, GRID_SPACING uint16) MAVLinkMessage

func NewVfrHud

func NewVfrHud(AIRSPEED float32, GROUNDSPEED float32, ALT float32, CLIMB float32, HEADING int16, THROTTLE uint16) MAVLinkMessage

func NewViconPositionEstimate

func NewViconPositionEstimate(USEC uint64, X float32, Y float32, Z float32, ROLL float32, PITCH float32, YAW float32) MAVLinkMessage

func NewVisionPositionEstimate

func NewVisionPositionEstimate(USEC uint64, X float32, Y float32, Z float32, ROLL float32, PITCH float32, YAW float32) MAVLinkMessage

func NewVisionSpeedEstimate

func NewVisionSpeedEstimate(USEC uint64, X float32, Y float32, Z float32) MAVLinkMessage

type MAVLinkPacket

type MAVLinkPacket struct {
	Protocol    uint8
	Length      uint8
	Sequence    uint8
	SystemID    uint8
	ComponentID uint8
	MessageID   uint8
	Data        []uint8
	Checksum    uint16
}

func CraftMAVLinkPacket

func CraftMAVLinkPacket(SystemID uint8, ComponentID uint8, Message MAVLinkMessage) *MAVLinkPacket

func NewMAVLinkPacket

func NewMAVLinkPacket(Protocol uint8, Length uint8, Sequence uint8, SystemID uint8, ComponentID uint8, MessageID uint8, Data []uint8) *MAVLinkPacket

func ReadMAVLinkPacket

func ReadMAVLinkPacket(r io.Reader) (*MAVLinkPacket, error)

func (*MAVLinkPacket) Decode

func (m *MAVLinkPacket) Decode(buf []byte)

func (*MAVLinkPacket) MAVLinkMessage

func (m *MAVLinkPacket) MAVLinkMessage() (MAVLinkMessage, error)

func (*MAVLinkPacket) Pack

func (m *MAVLinkPacket) Pack() []byte

type ManualControl

type ManualControl struct {
	X       int16  ///< X-axis, normalized to the range [-1000,1000]. A value of INT16_MAX indicates that this axis is invalid. Generally corresponds to forward(1000)-backward(-1000) movement on a joystick and the pitch of a vehicle.
	Y       int16  ///< Y-axis, normalized to the range [-1000,1000]. A value of INT16_MAX indicates that this axis is invalid. Generally corresponds to left(-1000)-right(1000) movement on a joystick and the roll of a vehicle.
	Z       int16  ///< Z-axis, normalized to the range [-1000,1000]. A value of INT16_MAX indicates that this axis is invalid. Generally corresponds to a separate slider movement with maximum being 1000 and minimum being -1000 on a joystick and the thrust of a vehicle.
	R       int16  ///< R-axis, normalized to the range [-1000,1000]. A value of INT16_MAX indicates that this axis is invalid. Generally corresponds to a twisting of the joystick, with counter-clockwise being 1000 and clockwise being -1000, and the yaw of a vehicle.
	BUTTONS uint16 ///< A bitfield corresponding to the joystick buttons' current state, 1 for pressed, 0 for released. The lowest bit corresponds to Button 1.
	TARGET  uint8  ///< The system to be controlled.
}

func (*ManualControl) Crc

func (*ManualControl) Crc() uint8

func (*ManualControl) Decode

func (m *ManualControl) Decode(buf []byte)

func (*ManualControl) Id

func (*ManualControl) Id() uint8

func (*ManualControl) Len

func (*ManualControl) Len() uint8

func (*ManualControl) Pack

func (m *ManualControl) Pack() []byte

type ManualSetpoint

type ManualSetpoint struct {
	TIME_BOOT_MS           uint32  ///< Timestamp in milliseconds since system boot
	ROLL                   float32 ///< Desired roll rate in radians per second
	PITCH                  float32 ///< Desired pitch rate in radians per second
	YAW                    float32 ///< Desired yaw rate in radians per second
	THRUST                 float32 ///< Collective thrust, normalized to 0 .. 1
	MODE_SWITCH            uint8   ///< Flight mode switch position, 0.. 255
	MANUAL_OVERRIDE_SWITCH uint8   ///< Override mode switch position, 0.. 255
}

func (*ManualSetpoint) Crc

func (*ManualSetpoint) Crc() uint8

func (*ManualSetpoint) Decode

func (m *ManualSetpoint) Decode(buf []byte)

func (*ManualSetpoint) Id

func (*ManualSetpoint) Id() uint8

func (*ManualSetpoint) Len

func (*ManualSetpoint) Len() uint8

func (*ManualSetpoint) Pack

func (m *ManualSetpoint) Pack() []byte

type MemoryVect

type MemoryVect struct {
	ADDRESS uint16   ///< Starting address of the debug variables
	VER     uint8    ///< Version code of the type variable. 0=unknown, type ignored and assumed int16_t. 1=as below
	TYPE    uint8    ///< Type code of the memory variables. for ver = 1: 0=16 x int16_t, 1=16 x uint16_t, 2=16 x Q15, 3=16 x 1Q14
	VALUE   [32]int8 ///< Memory contents at specified address
}

func (*MemoryVect) Crc

func (*MemoryVect) Crc() uint8

func (*MemoryVect) Decode

func (m *MemoryVect) Decode(buf []byte)

func (*MemoryVect) Id

func (*MemoryVect) Id() uint8

func (*MemoryVect) Len

func (*MemoryVect) Len() uint8

func (*MemoryVect) Pack

func (m *MemoryVect) Pack() []byte

type MissionAck

type MissionAck struct {
	TARGET_SYSTEM    uint8 ///< System ID
	TARGET_COMPONENT uint8 ///< Component ID
	TYPE             uint8 ///< See MAV_MISSION_RESULT enum
}

func (*MissionAck) Crc

func (*MissionAck) Crc() uint8

func (*MissionAck) Decode

func (m *MissionAck) Decode(buf []byte)

func (*MissionAck) Id

func (*MissionAck) Id() uint8

func (*MissionAck) Len

func (*MissionAck) Len() uint8

func (*MissionAck) Pack

func (m *MissionAck) Pack() []byte

type MissionClearAll

type MissionClearAll struct {
	TARGET_SYSTEM    uint8 ///< System ID
	TARGET_COMPONENT uint8 ///< Component ID
}

func (*MissionClearAll) Crc

func (*MissionClearAll) Crc() uint8

func (*MissionClearAll) Decode

func (m *MissionClearAll) Decode(buf []byte)

func (*MissionClearAll) Id

func (*MissionClearAll) Id() uint8

func (*MissionClearAll) Len

func (*MissionClearAll) Len() uint8

func (*MissionClearAll) Pack

func (m *MissionClearAll) Pack() []byte

type MissionCount

type MissionCount struct {
	COUNT            uint16 ///< Number of mission items in the sequence
	TARGET_SYSTEM    uint8  ///< System ID
	TARGET_COMPONENT uint8  ///< Component ID
}

func (*MissionCount) Crc

func (*MissionCount) Crc() uint8

func (*MissionCount) Decode

func (m *MissionCount) Decode(buf []byte)

func (*MissionCount) Id

func (*MissionCount) Id() uint8

func (*MissionCount) Len

func (*MissionCount) Len() uint8

func (*MissionCount) Pack

func (m *MissionCount) Pack() []byte

type MissionCurrent

type MissionCurrent struct {
	SEQ uint16 ///< Sequence
}

func (*MissionCurrent) Crc

func (*MissionCurrent) Crc() uint8

func (*MissionCurrent) Decode

func (m *MissionCurrent) Decode(buf []byte)

func (*MissionCurrent) Id

func (*MissionCurrent) Id() uint8

func (*MissionCurrent) Len

func (*MissionCurrent) Len() uint8

func (*MissionCurrent) Pack

func (m *MissionCurrent) Pack() []byte

type MissionItem

type MissionItem struct {
	PARAM1           float32 ///< PARAM1, see MAV_CMD enum
	PARAM2           float32 ///< PARAM2, see MAV_CMD enum
	PARAM3           float32 ///< PARAM3, see MAV_CMD enum
	PARAM4           float32 ///< PARAM4, see MAV_CMD enum
	X                float32 ///< PARAM5 / local: x position, global: latitude
	Y                float32 ///< PARAM6 / y position: global: longitude
	Z                float32 ///< PARAM7 / z position: global: altitude (relative or absolute, depending on frame.
	SEQ              uint16  ///< Sequence
	COMMAND          uint16  ///< The scheduled action for the MISSION. see MAV_CMD in common.xml MAVLink specs
	TARGET_SYSTEM    uint8   ///< System ID
	TARGET_COMPONENT uint8   ///< Component ID
	FRAME            uint8   ///< The coordinate system of the MISSION. see MAV_FRAME in mavlink_types.h
	CURRENT          uint8   ///< false:0, true:1
	AUTOCONTINUE     uint8   ///< autocontinue to next wp
}

func (*MissionItem) Crc

func (*MissionItem) Crc() uint8

func (*MissionItem) Decode

func (m *MissionItem) Decode(buf []byte)

func (*MissionItem) Id

func (*MissionItem) Id() uint8

func (*MissionItem) Len

func (*MissionItem) Len() uint8

func (*MissionItem) Pack

func (m *MissionItem) Pack() []byte

type MissionItemReached

type MissionItemReached struct {
	SEQ uint16 ///< Sequence
}

func (*MissionItemReached) Crc

func (*MissionItemReached) Crc() uint8

func (*MissionItemReached) Decode

func (m *MissionItemReached) Decode(buf []byte)

func (*MissionItemReached) Id

func (*MissionItemReached) Id() uint8

func (*MissionItemReached) Len

func (*MissionItemReached) Len() uint8

func (*MissionItemReached) Pack

func (m *MissionItemReached) Pack() []byte

type MissionRequest

type MissionRequest struct {
	SEQ              uint16 ///< Sequence
	TARGET_SYSTEM    uint8  ///< System ID
	TARGET_COMPONENT uint8  ///< Component ID
}

func (*MissionRequest) Crc

func (*MissionRequest) Crc() uint8

func (*MissionRequest) Decode

func (m *MissionRequest) Decode(buf []byte)

func (*MissionRequest) Id

func (*MissionRequest) Id() uint8

func (*MissionRequest) Len

func (*MissionRequest) Len() uint8

func (*MissionRequest) Pack

func (m *MissionRequest) Pack() []byte

type MissionRequestList

type MissionRequestList struct {
	TARGET_SYSTEM    uint8 ///< System ID
	TARGET_COMPONENT uint8 ///< Component ID
}

func (*MissionRequestList) Crc

func (*MissionRequestList) Crc() uint8

func (*MissionRequestList) Decode

func (m *MissionRequestList) Decode(buf []byte)

func (*MissionRequestList) Id

func (*MissionRequestList) Id() uint8

func (*MissionRequestList) Len

func (*MissionRequestList) Len() uint8

func (*MissionRequestList) Pack

func (m *MissionRequestList) Pack() []byte

type MissionRequestPartialList

type MissionRequestPartialList struct {
	START_INDEX      int16 ///< Start index, 0 by default
	END_INDEX        int16 ///< End index, -1 by default (-1: send list to end). Else a valid index of the list
	TARGET_SYSTEM    uint8 ///< System ID
	TARGET_COMPONENT uint8 ///< Component ID
}

func (*MissionRequestPartialList) Crc

func (*MissionRequestPartialList) Decode

func (m *MissionRequestPartialList) Decode(buf []byte)

func (*MissionRequestPartialList) Id

func (*MissionRequestPartialList) Len

func (*MissionRequestPartialList) Pack

func (m *MissionRequestPartialList) Pack() []byte

type MissionSetCurrent

type MissionSetCurrent struct {
	SEQ              uint16 ///< Sequence
	TARGET_SYSTEM    uint8  ///< System ID
	TARGET_COMPONENT uint8  ///< Component ID
}

func (*MissionSetCurrent) Crc

func (*MissionSetCurrent) Crc() uint8

func (*MissionSetCurrent) Decode

func (m *MissionSetCurrent) Decode(buf []byte)

func (*MissionSetCurrent) Id

func (*MissionSetCurrent) Id() uint8

func (*MissionSetCurrent) Len

func (*MissionSetCurrent) Len() uint8

func (*MissionSetCurrent) Pack

func (m *MissionSetCurrent) Pack() []byte

type MissionWritePartialList

type MissionWritePartialList struct {
	START_INDEX      int16 ///< Start index, 0 by default and smaller / equal to the largest index of the current onboard list.
	END_INDEX        int16 ///< End index, equal or greater than start index.
	TARGET_SYSTEM    uint8 ///< System ID
	TARGET_COMPONENT uint8 ///< Component ID
}

func (*MissionWritePartialList) Crc

func (*MissionWritePartialList) Decode

func (m *MissionWritePartialList) Decode(buf []byte)

func (*MissionWritePartialList) Id

func (*MissionWritePartialList) Len

func (*MissionWritePartialList) Pack

func (m *MissionWritePartialList) Pack() []byte

type NamedValueFloat

type NamedValueFloat struct {
	TIME_BOOT_MS uint32    ///< Timestamp (milliseconds since system boot)
	VALUE        float32   ///< Floating point value
	NAME         [10]uint8 ///< Name of the debug variable
}

func (*NamedValueFloat) Crc

func (*NamedValueFloat) Crc() uint8

func (*NamedValueFloat) Decode

func (m *NamedValueFloat) Decode(buf []byte)

func (*NamedValueFloat) Id

func (*NamedValueFloat) Id() uint8

func (*NamedValueFloat) Len

func (*NamedValueFloat) Len() uint8

func (*NamedValueFloat) Pack

func (m *NamedValueFloat) Pack() []byte

type NamedValueInt

type NamedValueInt struct {
	TIME_BOOT_MS uint32    ///< Timestamp (milliseconds since system boot)
	VALUE        int32     ///< Signed integer value
	NAME         [10]uint8 ///< Name of the debug variable
}

func (*NamedValueInt) Crc

func (*NamedValueInt) Crc() uint8

func (*NamedValueInt) Decode

func (m *NamedValueInt) Decode(buf []byte)

func (*NamedValueInt) Id

func (*NamedValueInt) Id() uint8

func (*NamedValueInt) Len

func (*NamedValueInt) Len() uint8

func (*NamedValueInt) Pack

func (m *NamedValueInt) Pack() []byte
type NavControllerOutput struct {
	NAV_ROLL       float32 ///< Current desired roll in degrees
	NAV_PITCH      float32 ///< Current desired pitch in degrees
	ALT_ERROR      float32 ///< Current altitude error in meters
	ASPD_ERROR     float32 ///< Current airspeed error in meters/second
	XTRACK_ERROR   float32 ///< Current crosstrack error on x-y plane in meters
	NAV_BEARING    int16   ///< Current desired heading in degrees
	TARGET_BEARING int16   ///< Bearing to current MISSION/target in degrees
	WP_DIST        uint16  ///< Distance to active MISSION in meters
}
func (*NavControllerOutput) Crc() uint8
func (m *NavControllerOutput) Decode(buf []byte)
func (*NavControllerOutput) Id() uint8
func (*NavControllerOutput) Len() uint8
func (m *NavControllerOutput) Pack() []byte

type OmnidirectionalFlow

type OmnidirectionalFlow struct {
	TIME_USEC        uint64    ///< Timestamp (microseconds, synced to UNIX time or since system boot)
	FRONT_DISTANCE_M float32   ///< Front distance in meters. Positive value (including zero): distance known. Negative value: Unknown distance
	LEFT             [10]int16 ///< Flow in deci pixels (1 = 0.1 pixel) on left hemisphere
	RIGHT            [10]int16 ///< Flow in deci pixels (1 = 0.1 pixel) on right hemisphere
	SENSOR_ID        uint8     ///< Sensor ID
	QUALITY          uint8     ///< Optical flow quality / confidence. 0: bad, 255: maximum quality
}

func (*OmnidirectionalFlow) Crc

func (*OmnidirectionalFlow) Crc() uint8

func (*OmnidirectionalFlow) Decode

func (m *OmnidirectionalFlow) Decode(buf []byte)

func (*OmnidirectionalFlow) Id

func (*OmnidirectionalFlow) Id() uint8

func (*OmnidirectionalFlow) Len

func (*OmnidirectionalFlow) Len() uint8

func (*OmnidirectionalFlow) Pack

func (m *OmnidirectionalFlow) Pack() []byte

type OpticalFlow

type OpticalFlow struct {
	TIME_USEC       uint64  ///< Timestamp (UNIX)
	FLOW_COMP_M_X   float32 ///< Flow in meters in x-sensor direction, angular-speed compensated
	FLOW_COMP_M_Y   float32 ///< Flow in meters in y-sensor direction, angular-speed compensated
	GROUND_DISTANCE float32 ///< Ground distance in meters. Positive value: distance known. Negative value: Unknown distance
	FLOW_X          int16   ///< Flow in pixels * 10 in x-sensor direction (dezi-pixels)
	FLOW_Y          int16   ///< Flow in pixels * 10 in y-sensor direction (dezi-pixels)
	SENSOR_ID       uint8   ///< Sensor ID
	QUALITY         uint8   ///< Optical flow quality / confidence. 0: bad, 255: maximum quality
}

func (*OpticalFlow) Crc

func (*OpticalFlow) Crc() uint8

func (*OpticalFlow) Decode

func (m *OpticalFlow) Decode(buf []byte)

func (*OpticalFlow) Id

func (*OpticalFlow) Id() uint8

func (*OpticalFlow) Len

func (*OpticalFlow) Len() uint8

func (*OpticalFlow) Pack

func (m *OpticalFlow) Pack() []byte

type ParamRequestList

type ParamRequestList struct {
	TARGET_SYSTEM    uint8 ///< System ID
	TARGET_COMPONENT uint8 ///< Component ID
}

func (*ParamRequestList) Crc

func (*ParamRequestList) Crc() uint8

func (*ParamRequestList) Decode

func (m *ParamRequestList) Decode(buf []byte)

func (*ParamRequestList) Id

func (*ParamRequestList) Id() uint8

func (*ParamRequestList) Len

func (*ParamRequestList) Len() uint8

func (*ParamRequestList) Pack

func (m *ParamRequestList) Pack() []byte

type ParamRequestRead

type ParamRequestRead struct {
	PARAM_INDEX      int16     ///< Parameter index. Send -1 to use the param ID field as identifier (else the param id will be ignored)
	TARGET_SYSTEM    uint8     ///< System ID
	TARGET_COMPONENT uint8     ///< Component ID
	PARAM_ID         [16]uint8 ///< Onboard parameter id, terminated by NULL if the length is less than 16 human-readable chars and WITHOUT null termination (NULL) byte if the length is exactly 16 chars - applications have to provide 16+1 bytes storage if the ID is stored as string
}

func (*ParamRequestRead) Crc

func (*ParamRequestRead) Crc() uint8

func (*ParamRequestRead) Decode

func (m *ParamRequestRead) Decode(buf []byte)

func (*ParamRequestRead) Id

func (*ParamRequestRead) Id() uint8

func (*ParamRequestRead) Len

func (*ParamRequestRead) Len() uint8

func (*ParamRequestRead) Pack

func (m *ParamRequestRead) Pack() []byte

type ParamSet

type ParamSet struct {
	PARAM_VALUE      float32   ///< Onboard parameter value
	TARGET_SYSTEM    uint8     ///< System ID
	TARGET_COMPONENT uint8     ///< Component ID
	PARAM_ID         [16]uint8 ///< Onboard parameter id, terminated by NULL if the length is less than 16 human-readable chars and WITHOUT null termination (NULL) byte if the length is exactly 16 chars - applications have to provide 16+1 bytes storage if the ID is stored as string
	PARAM_TYPE       uint8     ///< Onboard parameter type: see the MAV_PARAM_TYPE enum for supported data types.
}

func (*ParamSet) Crc

func (*ParamSet) Crc() uint8

func (*ParamSet) Decode

func (m *ParamSet) Decode(buf []byte)

func (*ParamSet) Id

func (*ParamSet) Id() uint8

func (*ParamSet) Len

func (*ParamSet) Len() uint8

func (*ParamSet) Pack

func (m *ParamSet) Pack() []byte

type ParamValue

type ParamValue struct {
	PARAM_VALUE float32   ///< Onboard parameter value
	PARAM_COUNT uint16    ///< Total number of onboard parameters
	PARAM_INDEX uint16    ///< Index of this onboard parameter
	PARAM_ID    [16]uint8 ///< Onboard parameter id, terminated by NULL if the length is less than 16 human-readable chars and WITHOUT null termination (NULL) byte if the length is exactly 16 chars - applications have to provide 16+1 bytes storage if the ID is stored as string
	PARAM_TYPE  uint8     ///< Onboard parameter type: see the MAV_PARAM_TYPE enum for supported data types.
}

func (*ParamValue) Crc

func (*ParamValue) Crc() uint8

func (*ParamValue) Decode

func (m *ParamValue) Decode(buf []byte)

func (*ParamValue) Id

func (*ParamValue) Id() uint8

func (*ParamValue) Len

func (*ParamValue) Len() uint8

func (*ParamValue) Pack

func (m *ParamValue) Pack() []byte

type Ping

type Ping struct {
	TIME_USEC        uint64 ///< Unix timestamp in microseconds
	SEQ              uint32 ///< PING sequence
	TARGET_SYSTEM    uint8  ///< 0: request ping from all receiving systems, if greater than 0: message is a ping response and number is the system id of the requesting system
	TARGET_COMPONENT uint8  ///< 0: request ping from all receiving components, if greater than 0: message is a ping response and number is the system id of the requesting system
}

func (*Ping) Crc

func (*Ping) Crc() uint8

func (*Ping) Decode

func (m *Ping) Decode(buf []byte)

func (*Ping) Id

func (*Ping) Id() uint8

func (*Ping) Len

func (*Ping) Len() uint8

func (*Ping) Pack

func (m *Ping) Pack() []byte

type PowerStatus

type PowerStatus struct {
	VCC    uint16 ///< 5V rail voltage in millivolts
	VSERVO uint16 ///< servo rail voltage in millivolts
	FLAGS  uint16 ///< power supply status flags (see MAV_POWER_STATUS enum)
}

func (*PowerStatus) Crc

func (*PowerStatus) Crc() uint8

func (*PowerStatus) Decode

func (m *PowerStatus) Decode(buf []byte)

func (*PowerStatus) Id

func (*PowerStatus) Id() uint8

func (*PowerStatus) Len

func (*PowerStatus) Len() uint8

func (*PowerStatus) Pack

func (m *PowerStatus) Pack() []byte

type RadioStatus

type RadioStatus struct {
	RXERRORS uint16 ///< receive errors
	FIXED    uint16 ///< count of error corrected packets
	RSSI     uint8  ///< local signal strength
	REMRSSI  uint8  ///< remote signal strength
	TXBUF    uint8  ///< how full the tx buffer is as a percentage
	NOISE    uint8  ///< background noise level
	REMNOISE uint8  ///< remote background noise level
}

func (*RadioStatus) Crc

func (*RadioStatus) Crc() uint8

func (*RadioStatus) Decode

func (m *RadioStatus) Decode(buf []byte)

func (*RadioStatus) Id

func (*RadioStatus) Id() uint8

func (*RadioStatus) Len

func (*RadioStatus) Len() uint8

func (*RadioStatus) Pack

func (m *RadioStatus) Pack() []byte

type RawImu

type RawImu struct {
	TIME_USEC uint64 ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	XACC      int16  ///< X acceleration (raw)
	YACC      int16  ///< Y acceleration (raw)
	ZACC      int16  ///< Z acceleration (raw)
	XGYRO     int16  ///< Angular speed around X axis (raw)
	YGYRO     int16  ///< Angular speed around Y axis (raw)
	ZGYRO     int16  ///< Angular speed around Z axis (raw)
	XMAG      int16  ///< X Magnetic field (raw)
	YMAG      int16  ///< Y Magnetic field (raw)
	ZMAG      int16  ///< Z Magnetic field (raw)
}

func (*RawImu) Crc

func (*RawImu) Crc() uint8

func (*RawImu) Decode

func (m *RawImu) Decode(buf []byte)

func (*RawImu) Id

func (*RawImu) Id() uint8

func (*RawImu) Len

func (*RawImu) Len() uint8

func (*RawImu) Pack

func (m *RawImu) Pack() []byte

type RawPressure

type RawPressure struct {
	TIME_USEC   uint64 ///< Timestamp (microseconds since UNIX epoch or microseconds since system boot)
	PRESS_ABS   int16  ///< Absolute pressure (raw)
	PRESS_DIFF1 int16  ///< Differential pressure 1 (raw)
	PRESS_DIFF2 int16  ///< Differential pressure 2 (raw)
	TEMPERATURE int16  ///< Raw Temperature measurement (raw)
}

func (*RawPressure) Crc

func (*RawPressure) Crc() uint8

func (*RawPressure) Decode

func (m *RawPressure) Decode(buf []byte)

func (*RawPressure) Id

func (*RawPressure) Id() uint8

func (*RawPressure) Len

func (*RawPressure) Len() uint8

func (*RawPressure) Pack

func (m *RawPressure) Pack() []byte

type RcChannels

type RcChannels struct {
	TIME_BOOT_MS uint32 ///< Timestamp (milliseconds since system boot)
	CHAN1_RAW    uint16 ///< RC channel 1 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN2_RAW    uint16 ///< RC channel 2 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN3_RAW    uint16 ///< RC channel 3 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN4_RAW    uint16 ///< RC channel 4 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN5_RAW    uint16 ///< RC channel 5 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN6_RAW    uint16 ///< RC channel 6 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN7_RAW    uint16 ///< RC channel 7 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN8_RAW    uint16 ///< RC channel 8 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN9_RAW    uint16 ///< RC channel 9 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN10_RAW   uint16 ///< RC channel 10 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN11_RAW   uint16 ///< RC channel 11 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN12_RAW   uint16 ///< RC channel 12 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN13_RAW   uint16 ///< RC channel 13 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN14_RAW   uint16 ///< RC channel 14 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN15_RAW   uint16 ///< RC channel 15 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN16_RAW   uint16 ///< RC channel 16 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN17_RAW   uint16 ///< RC channel 17 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN18_RAW   uint16 ///< RC channel 18 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHANCOUNT    uint8  ///< Total number of RC channels being received. This can be larger than 18, indicating that more channels are available but not given in this message. This value should be 0 when no RC channels are available.
	RSSI         uint8  ///< Receive signal strength indicator, 0: 0%, 100: 100%, 255: invalid/unknown.
}

func (*RcChannels) Crc

func (*RcChannels) Crc() uint8

func (*RcChannels) Decode

func (m *RcChannels) Decode(buf []byte)

func (*RcChannels) Id

func (*RcChannels) Id() uint8

func (*RcChannels) Len

func (*RcChannels) Len() uint8

func (*RcChannels) Pack

func (m *RcChannels) Pack() []byte

type RcChannelsOverride

type RcChannelsOverride struct {
	CHAN1_RAW        uint16 ///< RC channel 1 value, in microseconds. A value of UINT16_MAX means to ignore this field.
	CHAN2_RAW        uint16 ///< RC channel 2 value, in microseconds. A value of UINT16_MAX means to ignore this field.
	CHAN3_RAW        uint16 ///< RC channel 3 value, in microseconds. A value of UINT16_MAX means to ignore this field.
	CHAN4_RAW        uint16 ///< RC channel 4 value, in microseconds. A value of UINT16_MAX means to ignore this field.
	CHAN5_RAW        uint16 ///< RC channel 5 value, in microseconds. A value of UINT16_MAX means to ignore this field.
	CHAN6_RAW        uint16 ///< RC channel 6 value, in microseconds. A value of UINT16_MAX means to ignore this field.
	CHAN7_RAW        uint16 ///< RC channel 7 value, in microseconds. A value of UINT16_MAX means to ignore this field.
	CHAN8_RAW        uint16 ///< RC channel 8 value, in microseconds. A value of UINT16_MAX means to ignore this field.
	TARGET_SYSTEM    uint8  ///< System ID
	TARGET_COMPONENT uint8  ///< Component ID
}

func (*RcChannelsOverride) Crc

func (*RcChannelsOverride) Crc() uint8

func (*RcChannelsOverride) Decode

func (m *RcChannelsOverride) Decode(buf []byte)

func (*RcChannelsOverride) Id

func (*RcChannelsOverride) Id() uint8

func (*RcChannelsOverride) Len

func (*RcChannelsOverride) Len() uint8

func (*RcChannelsOverride) Pack

func (m *RcChannelsOverride) Pack() []byte

type RcChannelsRaw

type RcChannelsRaw struct {
	TIME_BOOT_MS uint32 ///< Timestamp (milliseconds since system boot)
	CHAN1_RAW    uint16 ///< RC channel 1 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN2_RAW    uint16 ///< RC channel 2 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN3_RAW    uint16 ///< RC channel 3 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN4_RAW    uint16 ///< RC channel 4 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN5_RAW    uint16 ///< RC channel 5 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN6_RAW    uint16 ///< RC channel 6 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN7_RAW    uint16 ///< RC channel 7 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	CHAN8_RAW    uint16 ///< RC channel 8 value, in microseconds. A value of UINT16_MAX implies the channel is unused.
	PORT         uint8  ///< Servo output port (set of 8 outputs = 1 port). Most MAVs will just use one, but this allows for more than 8 servos.
	RSSI         uint8  ///< Receive signal strength indicator, 0: 0%, 100: 100%, 255: invalid/unknown.
}

func (*RcChannelsRaw) Crc

func (*RcChannelsRaw) Crc() uint8

func (*RcChannelsRaw) Decode

func (m *RcChannelsRaw) Decode(buf []byte)

func (*RcChannelsRaw) Id

func (*RcChannelsRaw) Id() uint8

func (*RcChannelsRaw) Len

func (*RcChannelsRaw) Len() uint8

func (*RcChannelsRaw) Pack

func (m *RcChannelsRaw) Pack() []byte

type RcChannelsScaled

type RcChannelsScaled struct {
	TIME_BOOT_MS uint32 ///< Timestamp (milliseconds since system boot)
	CHAN1_SCALED int16  ///< RC channel 1 value scaled, (-100%) -10000, (0%) 0, (100%) 10000, (invalid) INT16_MAX.
	CHAN2_SCALED int16  ///< RC channel 2 value scaled, (-100%) -10000, (0%) 0, (100%) 10000, (invalid) INT16_MAX.
	CHAN3_SCALED int16  ///< RC channel 3 value scaled, (-100%) -10000, (0%) 0, (100%) 10000, (invalid) INT16_MAX.
	CHAN4_SCALED int16  ///< RC channel 4 value scaled, (-100%) -10000, (0%) 0, (100%) 10000, (invalid) INT16_MAX.
	CHAN5_SCALED int16  ///< RC channel 5 value scaled, (-100%) -10000, (0%) 0, (100%) 10000, (invalid) INT16_MAX.
	CHAN6_SCALED int16  ///< RC channel 6 value scaled, (-100%) -10000, (0%) 0, (100%) 10000, (invalid) INT16_MAX.
	CHAN7_SCALED int16  ///< RC channel 7 value scaled, (-100%) -10000, (0%) 0, (100%) 10000, (invalid) INT16_MAX.
	CHAN8_SCALED int16  ///< RC channel 8 value scaled, (-100%) -10000, (0%) 0, (100%) 10000, (invalid) INT16_MAX.
	PORT         uint8  ///< Servo output port (set of 8 outputs = 1 port). Most MAVs will just use one, but this allows for more than 8 servos.
	RSSI         uint8  ///< Receive signal strength indicator, 0: 0%, 100: 100%, 255: invalid/unknown.
}

func (*RcChannelsScaled) Crc

func (*RcChannelsScaled) Crc() uint8

func (*RcChannelsScaled) Decode

func (m *RcChannelsScaled) Decode(buf []byte)

func (*RcChannelsScaled) Id

func (*RcChannelsScaled) Id() uint8

func (*RcChannelsScaled) Len

func (*RcChannelsScaled) Len() uint8

func (*RcChannelsScaled) Pack

func (m *RcChannelsScaled) Pack() []byte

type RequestDataStream

type RequestDataStream struct {
	REQ_MESSAGE_RATE uint16 ///< The requested interval between two messages of this type
	TARGET_SYSTEM    uint8  ///< The target requested to send the message stream.
	TARGET_COMPONENT uint8  ///< The target requested to send the message stream.
	REQ_STREAM_ID    uint8  ///< The ID of the requested data stream
	START_STOP       uint8  ///< 1 to start sending, 0 to stop sending.
}

func (*RequestDataStream) Crc

func (*RequestDataStream) Crc() uint8

func (*RequestDataStream) Decode

func (m *RequestDataStream) Decode(buf []byte)

func (*RequestDataStream) Id

func (*RequestDataStream) Id() uint8

func (*RequestDataStream) Len

func (*RequestDataStream) Len() uint8

func (*RequestDataStream) Pack

func (m *RequestDataStream) Pack() []byte

type RollPitchYawRatesThrustSetpoint

type RollPitchYawRatesThrustSetpoint struct {
	TIME_BOOT_MS uint32  ///< Timestamp in milliseconds since system boot
	ROLL_RATE    float32 ///< Desired roll rate in radians per second
	PITCH_RATE   float32 ///< Desired pitch rate in radians per second
	YAW_RATE     float32 ///< Desired yaw rate in radians per second
	THRUST       float32 ///< Collective thrust, normalized to 0 .. 1
}

func (*RollPitchYawRatesThrustSetpoint) Crc

func (*RollPitchYawRatesThrustSetpoint) Decode

func (m *RollPitchYawRatesThrustSetpoint) Decode(buf []byte)

func (*RollPitchYawRatesThrustSetpoint) Id

func (*RollPitchYawRatesThrustSetpoint) Len

func (*RollPitchYawRatesThrustSetpoint) Pack

type RollPitchYawSpeedThrustSetpoint

type RollPitchYawSpeedThrustSetpoint struct {
	TIME_BOOT_MS uint32  ///< Timestamp in milliseconds since system boot
	ROLL_SPEED   float32 ///< Desired roll angular speed in rad/s
	PITCH_SPEED  float32 ///< Desired pitch angular speed in rad/s
	YAW_SPEED    float32 ///< Desired yaw angular speed in rad/s
	THRUST       float32 ///< Collective thrust, normalized to 0 .. 1
}

func (*RollPitchYawSpeedThrustSetpoint) Crc

func (*RollPitchYawSpeedThrustSetpoint) Decode

func (m *RollPitchYawSpeedThrustSetpoint) Decode(buf []byte)

func (*RollPitchYawSpeedThrustSetpoint) Id

func (*RollPitchYawSpeedThrustSetpoint) Len

func (*RollPitchYawSpeedThrustSetpoint) Pack

type RollPitchYawThrustSetpoint

type RollPitchYawThrustSetpoint struct {
	TIME_BOOT_MS uint32  ///< Timestamp in milliseconds since system boot
	ROLL         float32 ///< Desired roll angle in radians
	PITCH        float32 ///< Desired pitch angle in radians
	YAW          float32 ///< Desired yaw angle in radians
	THRUST       float32 ///< Collective thrust, normalized to 0 .. 1
}

func (*RollPitchYawThrustSetpoint) Crc

func (*RollPitchYawThrustSetpoint) Decode

func (m *RollPitchYawThrustSetpoint) Decode(buf []byte)

func (*RollPitchYawThrustSetpoint) Id

func (*RollPitchYawThrustSetpoint) Len

func (*RollPitchYawThrustSetpoint) Pack

func (m *RollPitchYawThrustSetpoint) Pack() []byte

type SafetyAllowedArea

type SafetyAllowedArea struct {
	P1X   float32 ///< x position 1 / Latitude 1
	P1Y   float32 ///< y position 1 / Longitude 1
	P1Z   float32 ///< z position 1 / Altitude 1
	P2X   float32 ///< x position 2 / Latitude 2
	P2Y   float32 ///< y position 2 / Longitude 2
	P2Z   float32 ///< z position 2 / Altitude 2
	FRAME uint8   ///< Coordinate frame, as defined by MAV_FRAME enum in mavlink_types.h. Can be either global, GPS, right-handed with Z axis up or local, right handed, Z axis down.
}

func (*SafetyAllowedArea) Crc

func (*SafetyAllowedArea) Crc() uint8

func (*SafetyAllowedArea) Decode

func (m *SafetyAllowedArea) Decode(buf []byte)

func (*SafetyAllowedArea) Id

func (*SafetyAllowedArea) Id() uint8

func (*SafetyAllowedArea) Len

func (*SafetyAllowedArea) Len() uint8

func (*SafetyAllowedArea) Pack

func (m *SafetyAllowedArea) Pack() []byte

type SafetySetAllowedArea

type SafetySetAllowedArea struct {
	P1X              float32 ///< x position 1 / Latitude 1
	P1Y              float32 ///< y position 1 / Longitude 1
	P1Z              float32 ///< z position 1 / Altitude 1
	P2X              float32 ///< x position 2 / Latitude 2
	P2Y              float32 ///< y position 2 / Longitude 2
	P2Z              float32 ///< z position 2 / Altitude 2
	TARGET_SYSTEM    uint8   ///< System ID
	TARGET_COMPONENT uint8   ///< Component ID
	FRAME            uint8   ///< Coordinate frame, as defined by MAV_FRAME enum in mavlink_types.h. Can be either global, GPS, right-handed with Z axis up or local, right handed, Z axis down.
}

func (*SafetySetAllowedArea) Crc

func (*SafetySetAllowedArea) Crc() uint8

func (*SafetySetAllowedArea) Decode

func (m *SafetySetAllowedArea) Decode(buf []byte)

func (*SafetySetAllowedArea) Id

func (*SafetySetAllowedArea) Len

func (*SafetySetAllowedArea) Len() uint8

func (*SafetySetAllowedArea) Pack

func (m *SafetySetAllowedArea) Pack() []byte

type ScaledImu

type ScaledImu struct {
	TIME_BOOT_MS uint32 ///< Timestamp (milliseconds since system boot)
	XACC         int16  ///< X acceleration (mg)
	YACC         int16  ///< Y acceleration (mg)
	ZACC         int16  ///< Z acceleration (mg)
	XGYRO        int16  ///< Angular speed around X axis (millirad /sec)
	YGYRO        int16  ///< Angular speed around Y axis (millirad /sec)
	ZGYRO        int16  ///< Angular speed around Z axis (millirad /sec)
	XMAG         int16  ///< X Magnetic field (milli tesla)
	YMAG         int16  ///< Y Magnetic field (milli tesla)
	ZMAG         int16  ///< Z Magnetic field (milli tesla)
}

func (*ScaledImu) Crc

func (*ScaledImu) Crc() uint8

func (*ScaledImu) Decode

func (m *ScaledImu) Decode(buf []byte)

func (*ScaledImu) Id

func (*ScaledImu) Id() uint8

func (*ScaledImu) Len

func (*ScaledImu) Len() uint8

func (*ScaledImu) Pack

func (m *ScaledImu) Pack() []byte

type ScaledImu2

type ScaledImu2 struct {
	TIME_BOOT_MS uint32 ///< Timestamp (milliseconds since system boot)
	XACC         int16  ///< X acceleration (mg)
	YACC         int16  ///< Y acceleration (mg)
	ZACC         int16  ///< Z acceleration (mg)
	XGYRO        int16  ///< Angular speed around X axis (millirad /sec)
	YGYRO        int16  ///< Angular speed around Y axis (millirad /sec)
	ZGYRO        int16  ///< Angular speed around Z axis (millirad /sec)
	XMAG         int16  ///< X Magnetic field (milli tesla)
	YMAG         int16  ///< Y Magnetic field (milli tesla)
	ZMAG         int16  ///< Z Magnetic field (milli tesla)
}

func (*ScaledImu2) Crc

func (*ScaledImu2) Crc() uint8

func (*ScaledImu2) Decode

func (m *ScaledImu2) Decode(buf []byte)

func (*ScaledImu2) Id

func (*ScaledImu2) Id() uint8

func (*ScaledImu2) Len

func (*ScaledImu2) Len() uint8

func (*ScaledImu2) Pack

func (m *ScaledImu2) Pack() []byte

type ScaledPressure

type ScaledPressure struct {
	TIME_BOOT_MS uint32  ///< Timestamp (milliseconds since system boot)
	PRESS_ABS    float32 ///< Absolute pressure (hectopascal)
	PRESS_DIFF   float32 ///< Differential pressure 1 (hectopascal)
	TEMPERATURE  int16   ///< Temperature measurement (0.01 degrees celsius)
}

func (*ScaledPressure) Crc

func (*ScaledPressure) Crc() uint8

func (*ScaledPressure) Decode

func (m *ScaledPressure) Decode(buf []byte)

func (*ScaledPressure) Id

func (*ScaledPressure) Id() uint8

func (*ScaledPressure) Len

func (*ScaledPressure) Len() uint8

func (*ScaledPressure) Pack

func (m *ScaledPressure) Pack() []byte

type SerialControl

type SerialControl struct {
	BAUDRATE uint32    ///< Baudrate of transfer. Zero means no change.
	TIMEOUT  uint16    ///< Timeout for reply data in milliseconds
	DEVICE   uint8     ///< See SERIAL_CONTROL_DEV enum
	FLAGS    uint8     ///< See SERIAL_CONTROL_FLAG enum
	COUNT    uint8     ///< how many bytes in this transfer
	DATA     [70]uint8 ///< serial data
}

func (*SerialControl) Crc

func (*SerialControl) Crc() uint8

func (*SerialControl) Decode

func (m *SerialControl) Decode(buf []byte)

func (*SerialControl) Id

func (*SerialControl) Id() uint8

func (*SerialControl) Len

func (*SerialControl) Len() uint8

func (*SerialControl) Pack

func (m *SerialControl) Pack() []byte

type ServoOutputRaw

type ServoOutputRaw struct {
	TIME_USEC  uint32 ///< Timestamp (microseconds since system boot)
	SERVO1_RAW uint16 ///< Servo output 1 value, in microseconds
	SERVO2_RAW uint16 ///< Servo output 2 value, in microseconds
	SERVO3_RAW uint16 ///< Servo output 3 value, in microseconds
	SERVO4_RAW uint16 ///< Servo output 4 value, in microseconds
	SERVO5_RAW uint16 ///< Servo output 5 value, in microseconds
	SERVO6_RAW uint16 ///< Servo output 6 value, in microseconds
	SERVO7_RAW uint16 ///< Servo output 7 value, in microseconds
	SERVO8_RAW uint16 ///< Servo output 8 value, in microseconds
	PORT       uint8  ///< Servo output port (set of 8 outputs = 1 port). Most MAVs will just use one, but this allows to encode more than 8 servos.
}

func (*ServoOutputRaw) Crc

func (*ServoOutputRaw) Crc() uint8

func (*ServoOutputRaw) Decode

func (m *ServoOutputRaw) Decode(buf []byte)

func (*ServoOutputRaw) Id

func (*ServoOutputRaw) Id() uint8

func (*ServoOutputRaw) Len

func (*ServoOutputRaw) Len() uint8

func (*ServoOutputRaw) Pack

func (m *ServoOutputRaw) Pack() []byte

type SetGlobalPositionSetpointInt

type SetGlobalPositionSetpointInt struct {
	LATITUDE         int32 ///< Latitude (WGS84), in degrees * 1E7
	LONGITUDE        int32 ///< Longitude (WGS84), in degrees * 1E7
	ALTITUDE         int32 ///< Altitude (WGS84), in meters * 1000 (positive for up)
	YAW              int16 ///< Desired yaw angle in degrees * 100
	COORDINATE_FRAME uint8 ///< Coordinate frame - valid values are only MAV_FRAME_GLOBAL or MAV_FRAME_GLOBAL_RELATIVE_ALT
}

func (*SetGlobalPositionSetpointInt) Crc

func (*SetGlobalPositionSetpointInt) Decode

func (m *SetGlobalPositionSetpointInt) Decode(buf []byte)

func (*SetGlobalPositionSetpointInt) Id

func (*SetGlobalPositionSetpointInt) Len

func (*SetGlobalPositionSetpointInt) Pack

func (m *SetGlobalPositionSetpointInt) Pack() []byte

type SetGpsGlobalOrigin

type SetGpsGlobalOrigin struct {
	LATITUDE      int32 ///< Latitude (WGS84), in degrees * 1E7
	LONGITUDE     int32 ///< Longitude (WGS84, in degrees * 1E7
	ALTITUDE      int32 ///< Altitude (WGS84), in meters * 1000 (positive for up)
	TARGET_SYSTEM uint8 ///< System ID
}

func (*SetGpsGlobalOrigin) Crc

func (*SetGpsGlobalOrigin) Crc() uint8

func (*SetGpsGlobalOrigin) Decode

func (m *SetGpsGlobalOrigin) Decode(buf []byte)

func (*SetGpsGlobalOrigin) Id

func (*SetGpsGlobalOrigin) Id() uint8

func (*SetGpsGlobalOrigin) Len

func (*SetGpsGlobalOrigin) Len() uint8

func (*SetGpsGlobalOrigin) Pack

func (m *SetGpsGlobalOrigin) Pack() []byte

type SetLocalPositionSetpoint

type SetLocalPositionSetpoint struct {
	X                float32 ///< x position
	Y                float32 ///< y position
	Z                float32 ///< z position
	YAW              float32 ///< Desired yaw angle
	TARGET_SYSTEM    uint8   ///< System ID
	TARGET_COMPONENT uint8   ///< Component ID
	COORDINATE_FRAME uint8   ///< Coordinate frame - valid values are only MAV_FRAME_LOCAL_NED or MAV_FRAME_LOCAL_ENU
}

func (*SetLocalPositionSetpoint) Crc

func (*SetLocalPositionSetpoint) Decode

func (m *SetLocalPositionSetpoint) Decode(buf []byte)

func (*SetLocalPositionSetpoint) Id

func (*SetLocalPositionSetpoint) Len

func (*SetLocalPositionSetpoint) Pack

func (m *SetLocalPositionSetpoint) Pack() []byte

type SetMode

type SetMode struct {
	CUSTOM_MODE   uint32 ///< The new autopilot-specific mode. This field can be ignored by an autopilot.
	TARGET_SYSTEM uint8  ///< The system setting the mode
	BASE_MODE     uint8  ///< The new base mode
}

func (*SetMode) Crc

func (*SetMode) Crc() uint8

func (*SetMode) Decode

func (m *SetMode) Decode(buf []byte)

func (*SetMode) Id

func (*SetMode) Id() uint8

func (*SetMode) Len

func (*SetMode) Len() uint8

func (*SetMode) Pack

func (m *SetMode) Pack() []byte

type SetQuadMotorsSetpoint

type SetQuadMotorsSetpoint struct {
	MOTOR_FRONT_NW uint16 ///< Front motor in + configuration, front left motor in x configuration
	MOTOR_RIGHT_NE uint16 ///< Right motor in + configuration, front right motor in x configuration
	MOTOR_BACK_SE  uint16 ///< Back motor in + configuration, back right motor in x configuration
	MOTOR_LEFT_SW  uint16 ///< Left motor in + configuration, back left motor in x configuration
	TARGET_SYSTEM  uint8  ///< System ID of the system that should set these motor commands
}

func (*SetQuadMotorsSetpoint) Crc

func (*SetQuadMotorsSetpoint) Decode

func (m *SetQuadMotorsSetpoint) Decode(buf []byte)

func (*SetQuadMotorsSetpoint) Id

func (*SetQuadMotorsSetpoint) Len

func (*SetQuadMotorsSetpoint) Pack

func (m *SetQuadMotorsSetpoint) Pack() []byte

type SetQuadSwarmLedRollPitchYawThrust

type SetQuadSwarmLedRollPitchYawThrust struct {
	ROLL      [4]int16  ///< Desired roll angle in radians +-PI (+-INT16_MAX)
	PITCH     [4]int16  ///< Desired pitch angle in radians +-PI (+-INT16_MAX)
	YAW       [4]int16  ///< Desired yaw angle in radians, scaled to int16 +-PI (+-INT16_MAX)
	THRUST    [4]uint16 ///< Collective thrust, scaled to uint16 (0..UINT16_MAX)
	GROUP     uint8     ///< ID of the quadrotor group (0 - 255, up to 256 groups supported)
	MODE      uint8     ///< ID of the flight mode (0 - 255, up to 256 modes supported)
	LED_RED   [4]uint8  ///< RGB red channel (0-255)
	LED_BLUE  [4]uint8  ///< RGB green channel (0-255)
	LED_GREEN [4]uint8  ///< RGB blue channel (0-255)
}

func (*SetQuadSwarmLedRollPitchYawThrust) Crc

func (*SetQuadSwarmLedRollPitchYawThrust) Decode

func (m *SetQuadSwarmLedRollPitchYawThrust) Decode(buf []byte)

func (*SetQuadSwarmLedRollPitchYawThrust) Id

func (*SetQuadSwarmLedRollPitchYawThrust) Len

func (*SetQuadSwarmLedRollPitchYawThrust) Pack

type SetQuadSwarmRollPitchYawThrust

type SetQuadSwarmRollPitchYawThrust struct {
	ROLL   [4]int16  ///< Desired roll angle in radians +-PI (+-INT16_MAX)
	PITCH  [4]int16  ///< Desired pitch angle in radians +-PI (+-INT16_MAX)
	YAW    [4]int16  ///< Desired yaw angle in radians, scaled to int16 +-PI (+-INT16_MAX)
	THRUST [4]uint16 ///< Collective thrust, scaled to uint16 (0..UINT16_MAX)
	GROUP  uint8     ///< ID of the quadrotor group (0 - 255, up to 256 groups supported)
	MODE   uint8     ///< ID of the flight mode (0 - 255, up to 256 modes supported)
}

func (*SetQuadSwarmRollPitchYawThrust) Crc

func (*SetQuadSwarmRollPitchYawThrust) Decode

func (m *SetQuadSwarmRollPitchYawThrust) Decode(buf []byte)

func (*SetQuadSwarmRollPitchYawThrust) Id

func (*SetQuadSwarmRollPitchYawThrust) Len

func (*SetQuadSwarmRollPitchYawThrust) Pack

type SetRollPitchYawSpeedThrust

type SetRollPitchYawSpeedThrust struct {
	ROLL_SPEED       float32 ///< Desired roll angular speed in rad/s
	PITCH_SPEED      float32 ///< Desired pitch angular speed in rad/s
	YAW_SPEED        float32 ///< Desired yaw angular speed in rad/s
	THRUST           float32 ///< Collective thrust, normalized to 0 .. 1
	TARGET_SYSTEM    uint8   ///< System ID
	TARGET_COMPONENT uint8   ///< Component ID
}

func (*SetRollPitchYawSpeedThrust) Crc

func (*SetRollPitchYawSpeedThrust) Decode

func (m *SetRollPitchYawSpeedThrust) Decode(buf []byte)

func (*SetRollPitchYawSpeedThrust) Id

func (*SetRollPitchYawSpeedThrust) Len

func (*SetRollPitchYawSpeedThrust) Pack

func (m *SetRollPitchYawSpeedThrust) Pack() []byte

type SetRollPitchYawThrust

type SetRollPitchYawThrust struct {
	ROLL             float32 ///< Desired roll angle in radians
	PITCH            float32 ///< Desired pitch angle in radians
	YAW              float32 ///< Desired yaw angle in radians
	THRUST           float32 ///< Collective thrust, normalized to 0 .. 1
	TARGET_SYSTEM    uint8   ///< System ID
	TARGET_COMPONENT uint8   ///< Component ID
}

func (*SetRollPitchYawThrust) Crc

func (*SetRollPitchYawThrust) Decode

func (m *SetRollPitchYawThrust) Decode(buf []byte)

func (*SetRollPitchYawThrust) Id

func (*SetRollPitchYawThrust) Len

func (*SetRollPitchYawThrust) Pack

func (m *SetRollPitchYawThrust) Pack() []byte

type Setpoint6Dof

type Setpoint6Dof struct {
	TRANS_X       float32 ///< Translational Component in x
	TRANS_Y       float32 ///< Translational Component in y
	TRANS_Z       float32 ///< Translational Component in z
	ROT_X         float32 ///< Rotational Component in x
	ROT_Y         float32 ///< Rotational Component in y
	ROT_Z         float32 ///< Rotational Component in z
	TARGET_SYSTEM uint8   ///< System ID
}

func (*Setpoint6Dof) Crc

func (*Setpoint6Dof) Crc() uint8

func (*Setpoint6Dof) Decode

func (m *Setpoint6Dof) Decode(buf []byte)

func (*Setpoint6Dof) Id

func (*Setpoint6Dof) Id() uint8

func (*Setpoint6Dof) Len

func (*Setpoint6Dof) Len() uint8

func (*Setpoint6Dof) Pack

func (m *Setpoint6Dof) Pack() []byte

type Setpoint8Dof

type Setpoint8Dof struct {
	VAL1          float32 ///< Value 1
	VAL2          float32 ///< Value 2
	VAL3          float32 ///< Value 3
	VAL4          float32 ///< Value 4
	VAL5          float32 ///< Value 5
	VAL6          float32 ///< Value 6
	VAL7          float32 ///< Value 7
	VAL8          float32 ///< Value 8
	TARGET_SYSTEM uint8   ///< System ID
}

func (*Setpoint8Dof) Crc

func (*Setpoint8Dof) Crc() uint8

func (*Setpoint8Dof) Decode

func (m *Setpoint8Dof) Decode(buf []byte)

func (*Setpoint8Dof) Id

func (*Setpoint8Dof) Id() uint8

func (*Setpoint8Dof) Len

func (*Setpoint8Dof) Len() uint8

func (*Setpoint8Dof) Pack

func (m *Setpoint8Dof) Pack() []byte

type SimState

type SimState struct {
	Q1           float32 ///< True attitude quaternion component 1, w (1 in null-rotation)
	Q2           float32 ///< True attitude quaternion component 2, x (0 in null-rotation)
	Q3           float32 ///< True attitude quaternion component 3, y (0 in null-rotation)
	Q4           float32 ///< True attitude quaternion component 4, z (0 in null-rotation)
	ROLL         float32 ///< Attitude roll expressed as Euler angles, not recommended except for human-readable outputs
	PITCH        float32 ///< Attitude pitch expressed as Euler angles, not recommended except for human-readable outputs
	YAW          float32 ///< Attitude yaw expressed as Euler angles, not recommended except for human-readable outputs
	XACC         float32 ///< X acceleration m/s/s
	YACC         float32 ///< Y acceleration m/s/s
	ZACC         float32 ///< Z acceleration m/s/s
	XGYRO        float32 ///< Angular speed around X axis rad/s
	YGYRO        float32 ///< Angular speed around Y axis rad/s
	ZGYRO        float32 ///< Angular speed around Z axis rad/s
	LAT          float32 ///< Latitude in degrees
	LON          float32 ///< Longitude in degrees
	ALT          float32 ///< Altitude in meters
	STD_DEV_HORZ float32 ///< Horizontal position standard deviation
	STD_DEV_VERT float32 ///< Vertical position standard deviation
	VN           float32 ///< True velocity in m/s in NORTH direction in earth-fixed NED frame
	VE           float32 ///< True velocity in m/s in EAST direction in earth-fixed NED frame
	VD           float32 ///< True velocity in m/s in DOWN direction in earth-fixed NED frame
}

func (*SimState) Crc

func (*SimState) Crc() uint8

func (*SimState) Decode

func (m *SimState) Decode(buf []byte)

func (*SimState) Id

func (*SimState) Id() uint8

func (*SimState) Len

func (*SimState) Len() uint8

func (*SimState) Pack

func (m *SimState) Pack() []byte

type StateCorrection

type StateCorrection struct {
	XERR     float32 ///< x position error
	YERR     float32 ///< y position error
	ZERR     float32 ///< z position error
	ROLLERR  float32 ///< roll error (radians)
	PITCHERR float32 ///< pitch error (radians)
	YAWERR   float32 ///< yaw error (radians)
	VXERR    float32 ///< x velocity
	VYERR    float32 ///< y velocity
	VZERR    float32 ///< z velocity
}

func (*StateCorrection) Crc

func (*StateCorrection) Crc() uint8

func (*StateCorrection) Decode

func (m *StateCorrection) Decode(buf []byte)

func (*StateCorrection) Id

func (*StateCorrection) Id() uint8

func (*StateCorrection) Len

func (*StateCorrection) Len() uint8

func (*StateCorrection) Pack

func (m *StateCorrection) Pack() []byte

type Statustext

type Statustext struct {
	SEVERITY uint8     ///< Severity of status. Relies on the definitions within RFC-5424. See enum MAV_SEVERITY.
	TEXT     [50]uint8 ///< Status text message, without null termination character
}

func (*Statustext) Crc

func (*Statustext) Crc() uint8

func (*Statustext) Decode

func (m *Statustext) Decode(buf []byte)

func (*Statustext) Id

func (*Statustext) Id() uint8

func (*Statustext) Len

func (*Statustext) Len() uint8

func (*Statustext) Pack

func (m *Statustext) Pack() []byte

type SysStatus

type SysStatus struct {
	ONBOARD_CONTROL_SENSORS_PRESENT uint32 ///< Bitmask showing which onboard controllers and sensors are present. Value of 0: not present. Value of 1: present. Indices defined by ENUM MAV_SYS_STATUS_SENSOR
	ONBOARD_CONTROL_SENSORS_ENABLED uint32 ///< Bitmask showing which onboard controllers and sensors are enabled:  Value of 0: not enabled. Value of 1: enabled. Indices defined by ENUM MAV_SYS_STATUS_SENSOR
	ONBOARD_CONTROL_SENSORS_HEALTH  uint32 ///< Bitmask showing which onboard controllers and sensors are operational or have an error:  Value of 0: not enabled. Value of 1: enabled. Indices defined by ENUM MAV_SYS_STATUS_SENSOR
	LOAD                            uint16 ///< Maximum usage in percent of the mainloop time, (0%: 0, 100%: 1000) should be always below 1000
	VOLTAGE_BATTERY                 uint16 ///< Battery voltage, in millivolts (1 = 1 millivolt)
	CURRENT_BATTERY                 int16  ///< Battery current, in 10*milliamperes (1 = 10 milliampere), -1: autopilot does not measure the current
	DROP_RATE_COMM                  uint16 ///< Communication drops in percent, (0%: 0, 100%: 10'000), (UART, I2C, SPI, CAN), dropped packets on all links (packets that were corrupted on reception on the MAV)
	ERRORS_COMM                     uint16 ///< Communication errors (UART, I2C, SPI, CAN), dropped packets on all links (packets that were corrupted on reception on the MAV)
	ERRORS_COUNT1                   uint16 ///< Autopilot-specific errors
	ERRORS_COUNT2                   uint16 ///< Autopilot-specific errors
	ERRORS_COUNT3                   uint16 ///< Autopilot-specific errors
	ERRORS_COUNT4                   uint16 ///< Autopilot-specific errors
	BATTERY_REMAINING               int8   ///< Remaining battery energy: (0%: 0, 100%: 100), -1: autopilot estimate the remaining battery
}

func (*SysStatus) Crc

func (*SysStatus) Crc() uint8

func (*SysStatus) Decode

func (m *SysStatus) Decode(buf []byte)

func (*SysStatus) Id

func (*SysStatus) Id() uint8

func (*SysStatus) Len

func (*SysStatus) Len() uint8

func (*SysStatus) Pack

func (m *SysStatus) Pack() []byte

type SystemTime

type SystemTime struct {
	TIME_UNIX_USEC uint64 ///< Timestamp of the master clock in microseconds since UNIX epoch.
	TIME_BOOT_MS   uint32 ///< Timestamp of the component clock since boot time in milliseconds.
}

func (*SystemTime) Crc

func (*SystemTime) Crc() uint8

func (*SystemTime) Decode

func (m *SystemTime) Decode(buf []byte)

func (*SystemTime) Id

func (*SystemTime) Id() uint8

func (*SystemTime) Len

func (*SystemTime) Len() uint8

func (*SystemTime) Pack

func (m *SystemTime) Pack() []byte

type TerrainCheck

type TerrainCheck struct {
	LAT int32 ///< Latitude (degrees *10^7)
	LON int32 ///< Longitude (degrees *10^7)
}

func (*TerrainCheck) Crc

func (*TerrainCheck) Crc() uint8

func (*TerrainCheck) Decode

func (m *TerrainCheck) Decode(buf []byte)

func (*TerrainCheck) Id

func (*TerrainCheck) Id() uint8

func (*TerrainCheck) Len

func (*TerrainCheck) Len() uint8

func (*TerrainCheck) Pack

func (m *TerrainCheck) Pack() []byte

type TerrainData

type TerrainData struct {
	LAT          int32     ///< Latitude of SW corner of first grid (degrees *10^7)
	LON          int32     ///< Longitude of SW corner of first grid (in degrees *10^7)
	GRID_SPACING uint16    ///< Grid spacing in meters
	DATA         [16]int16 ///< Terrain data in meters AMSL
	GRIDBIT      uint8     ///< bit within the terrain request mask
}

func (*TerrainData) Crc

func (*TerrainData) Crc() uint8

func (*TerrainData) Decode

func (m *TerrainData) Decode(buf []byte)

func (*TerrainData) Id

func (*TerrainData) Id() uint8

func (*TerrainData) Len

func (*TerrainData) Len() uint8

func (*TerrainData) Pack

func (m *TerrainData) Pack() []byte

type TerrainReport

type TerrainReport struct {
	LAT            int32   ///< Latitude (degrees *10^7)
	LON            int32   ///< Longitude (degrees *10^7)
	TERRAIN_HEIGHT float32 ///< Terrain height in meters AMSL
	CURRENT_HEIGHT float32 ///< Current vehicle height above lat/lon terrain height (meters)
	SPACING        uint16  ///< grid spacing (zero if terrain at this location unavailable)
	PENDING        uint16  ///< Number of 4x4 terrain blocks waiting to be received or read from disk
	LOADED         uint16  ///< Number of 4x4 terrain blocks in memory
}

func (*TerrainReport) Crc

func (*TerrainReport) Crc() uint8

func (*TerrainReport) Decode

func (m *TerrainReport) Decode(buf []byte)

func (*TerrainReport) Id

func (*TerrainReport) Id() uint8

func (*TerrainReport) Len

func (*TerrainReport) Len() uint8

func (*TerrainReport) Pack

func (m *TerrainReport) Pack() []byte

type TerrainRequest

type TerrainRequest struct {
	MASK         uint64 ///< Bitmask of requested 4x4 grids (row major 8x7 array of grids, 56 bits)
	LAT          int32  ///< Latitude of SW corner of first grid (degrees *10^7)
	LON          int32  ///< Longitude of SW corner of first grid (in degrees *10^7)
	GRID_SPACING uint16 ///< Grid spacing in meters
}

func (*TerrainRequest) Crc

func (*TerrainRequest) Crc() uint8

func (*TerrainRequest) Decode

func (m *TerrainRequest) Decode(buf []byte)

func (*TerrainRequest) Id

func (*TerrainRequest) Id() uint8

func (*TerrainRequest) Len

func (*TerrainRequest) Len() uint8

func (*TerrainRequest) Pack

func (m *TerrainRequest) Pack() []byte

type VfrHud

type VfrHud struct {
	AIRSPEED    float32 ///< Current airspeed in m/s
	GROUNDSPEED float32 ///< Current ground speed in m/s
	ALT         float32 ///< Current altitude (MSL), in meters
	CLIMB       float32 ///< Current climb rate in meters/second
	HEADING     int16   ///< Current heading in degrees, in compass units (0..360, 0=north)
	THROTTLE    uint16  ///< Current throttle setting in integer percent, 0 to 100
}

func (*VfrHud) Crc

func (*VfrHud) Crc() uint8

func (*VfrHud) Decode

func (m *VfrHud) Decode(buf []byte)

func (*VfrHud) Id

func (*VfrHud) Id() uint8

func (*VfrHud) Len

func (*VfrHud) Len() uint8

func (*VfrHud) Pack

func (m *VfrHud) Pack() []byte

type ViconPositionEstimate

type ViconPositionEstimate struct {
	USEC  uint64  ///< Timestamp (microseconds, synced to UNIX time or since system boot)
	X     float32 ///< Global X position
	Y     float32 ///< Global Y position
	Z     float32 ///< Global Z position
	ROLL  float32 ///< Roll angle in rad
	PITCH float32 ///< Pitch angle in rad
	YAW   float32 ///< Yaw angle in rad
}

func (*ViconPositionEstimate) Crc

func (*ViconPositionEstimate) Decode

func (m *ViconPositionEstimate) Decode(buf []byte)

func (*ViconPositionEstimate) Id

func (*ViconPositionEstimate) Len

func (*ViconPositionEstimate) Pack

func (m *ViconPositionEstimate) Pack() []byte

type VisionPositionEstimate

type VisionPositionEstimate struct {
	USEC  uint64  ///< Timestamp (microseconds, synced to UNIX time or since system boot)
	X     float32 ///< Global X position
	Y     float32 ///< Global Y position
	Z     float32 ///< Global Z position
	ROLL  float32 ///< Roll angle in rad
	PITCH float32 ///< Pitch angle in rad
	YAW   float32 ///< Yaw angle in rad
}

func (*VisionPositionEstimate) Crc

func (*VisionPositionEstimate) Decode

func (m *VisionPositionEstimate) Decode(buf []byte)

func (*VisionPositionEstimate) Id

func (*VisionPositionEstimate) Len

func (*VisionPositionEstimate) Pack

func (m *VisionPositionEstimate) Pack() []byte

type VisionSpeedEstimate

type VisionSpeedEstimate struct {
	USEC uint64  ///< Timestamp (microseconds, synced to UNIX time or since system boot)
	X    float32 ///< Global X speed
	Y    float32 ///< Global Y speed
	Z    float32 ///< Global Z speed
}

func (*VisionSpeedEstimate) Crc

func (*VisionSpeedEstimate) Crc() uint8

func (*VisionSpeedEstimate) Decode

func (m *VisionSpeedEstimate) Decode(buf []byte)

func (*VisionSpeedEstimate) Id

func (*VisionSpeedEstimate) Id() uint8

func (*VisionSpeedEstimate) Len

func (*VisionSpeedEstimate) Len() uint8

func (*VisionSpeedEstimate) Pack

func (m *VisionSpeedEstimate) Pack() []byte

Jump to

Keyboard shortcuts

? : This menu
/ : Search site
f or F : Jump to
y or Y : Canonical URL