<description>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.</description>
<description>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.</description>
</entry>
<entryvalue="7"name="MAV_FRAME_LOCAL_OFFSET_NED">
<description>Offset to the current local frame. Anything expressed in this frame should be added to the current local frame position.</description>
</entry>
@ -432,7 +426,7 @@
@@ -432,7 +426,7 @@
<description>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.</description>
<description>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.</description>
<description>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 in degrees, second value / y: longitude in degrees, third value / z: positive altitude in meters with 0 being at ground level in terrain model.</description>
<description>Deploy payload on a Lat / Lon / Alt position. This includes the navigation to reach the required release position and velocity.</description>
<paramindex="1">Operation mode. 0: prepare single payload deploy (overwriting previous requests), but do not execute it. 1: execute payload deploy immediately (rejecting further deploy commands during execution, but allowing abort). 2: add payload deploy to existing deployment list.</param>
<paramindex="2">Desired approach vector in degrees compass heading (0..360). A negative value indicates the system can define the approach vector at will.</param>
<paramindex="3">Desired ground speed at release time. This can be overriden by the airframe in case it needs to meet minimum airspeed. A negative value indicates the system can define the ground speed at will.</param>
<paramindex="4">Minimum altitude clearance to the release position in meters. A negative value indicates the system can define the clearance at will.</param>
<paramindex="5">Latitude unscaled for MISSION_ITEM or in 1e7 degrees for MISSION_ITEM_INT</param>
<paramindex="6">Longitude unscaled for MISSION_ITEM or in 1e7 degrees for MISSION_ITEM_INT</param>
<fieldtype="uint8_t"name="base_mode"enum="MAV_MODE">The new base mode</field>
<fieldtype="uint32_t"name="custom_mode">The new autopilot-specific mode. This field can be ignored by an autopilot.</field>
</message>
<!-- reserved for PARAM_VALUE_UNION -->
<messageid="20"name="PARAM_REQUEST_READ">
<description>Request to read the onboard parameter with the param_id string id. Onboard parameters are stored as key[const char*] -> value[float]. This allows to send a parameter to any other component (such as the GCS) without the need of previous knowledge of possible parameter names. Thus the same GCS can store different parameters for different autopilots. See also http://qgroundcontrol.org/parameter_interface for a full documentation of QGroundControl and IMU code.</description>
<description>The attitude in the aeronautical frame (right-handed, Z-down, X-front, Y-right), expressed as quaternion.</description>
<description>The attitude in the aeronautical frame (right-handed, Z-down, X-front, Y-right), expressed as quaternion. Quaternion order is w, x, y, z and a zero rotation would be expressed as (1 0 0 0).</description>
<fieldtype="uint32_t"name="time_boot_ms">Timestamp (milliseconds since system boot)</field>
<fieldtype="float"name="q1">Quaternion component 1, w (1 in null-rotation)</field>
<fieldtype="float"name="q2">Quaternion component 2, x (0 in null-rotation)</field>
@ -1609,40 +1747,6 @@
@@ -1609,40 +1747,6 @@
<fieldtype="int32_t"name="longitude">Longitude (WGS84), in degrees * 1E7</field>
<fieldtype="int32_t"name="altitude">Altitude (WGS84), in meters * 1000 (positive for up)</field>
<description>Set the setpoint for a local position controller. This is the position in local coordinates the MAV should fly to. This message is sent by the path/MISSION planner to the onboard position controller. As some MAVs have a degree of freedom in yaw (e.g. all helicopters/quadrotors), the desired yaw angle is part of the message.</description>
<description>Set the current global position setpoint.</description>
<fieldtype="uint8_t"name="coordinate_frame">Coordinate frame - valid values are only MAV_FRAME_GLOBAL or MAV_FRAME_GLOBAL_RELATIVE_ALT</field>
<fieldtype="int32_t"name="latitude">Latitude (WGS84), in degrees * 1E7</field>
<fieldtype="int32_t"name="longitude">Longitude (WGS84), in degrees * 1E7</field>
<fieldtype="int32_t"name="altitude">Altitude (WGS84), in meters * 1000 (positive for up)</field>
<fieldtype="int16_t"name="yaw">Desired yaw angle in degrees * 100</field>
</message>
<messageid="54"name="SAFETY_SET_ALLOWED_AREA">
<description>Set a safety zone (volume), which is defined by two corners of a cube. This message can be used to tell the MAV which setpoints/MISSIONs to accept and which to reject. Safety areas are often enforced by national or competition regulations.</description>
<description>Setpoint for up to four quadrotors in a group / wing</description>
<fieldtype="uint8_t"name="group">ID of the quadrotor group (0 - 255, up to 256 groups supported)</field>
<fieldtype="uint8_t"name="mode">ID of the flight mode (0 - 255, up to 256 modes supported)</field>
<fieldtype="int16_t[4]"name="roll">Desired roll angle in radians +-PI (+-INT16_MAX)</field>
<fieldtype="int16_t[4]"name="pitch">Desired pitch angle in radians +-PI (+-INT16_MAX)</field>
<fieldtype="int16_t[4]"name="yaw">Desired yaw angle in radians, scaled to int16 +-PI (+-INT16_MAX)</field>
<fieldtype="uint16_t[4]"name="thrust">Collective thrust, scaled to uint16 (0..UINT16_MAX)</field>
<messageid="61"name="ATTITUDE_QUATERNION_COV">
<description>The attitude in the aeronautical frame (right-handed, Z-down, X-front, Y-right), expressed as quaternion. Quaternion order is w, x, y, z and a zero rotation would be expressed as (1 0 0 0).</description>
<fieldtype="uint32_t"name="time_boot_ms">Timestamp (milliseconds since system boot)</field>
<fieldtype="float[4]"name="q">Quaternion components, w, x, y, z (1 0 0 0 is the null-rotation)</field>
<description>Outputs of the APM navigation controller. The primary use of this message is to check the response and signs of the controller before actual flight and to assist with tuning controller parameters.</description>
@ -1727,29 +1789,32 @@
@@ -1727,29 +1789,32 @@
<fieldtype="float"name="aspd_error">Current airspeed error in meters/second</field>
<fieldtype="float"name="xtrack_error">Current crosstrack error on x-y plane in meters</field>
<description>Setpoint for up to four quadrotors in a group / wing</description>
<fieldtype="uint8_t"name="group">ID of the quadrotor group (0 - 255, up to 256 groups supported)</field>
<fieldtype="uint8_t"name="mode">ID of the flight mode (0 - 255, up to 256 modes supported)</field>
<fieldtype="uint8_t[4]"name="led_red">RGB red channel (0-255)</field>
<fieldtype="uint8_t[4]"name="led_blue">RGB green channel (0-255)</field>
<fieldtype="uint8_t[4]"name="led_green">RGB blue channel (0-255)</field>
<fieldtype="int16_t[4]"name="roll">Desired roll angle in radians +-PI (+-INT16_MAX)</field>
<fieldtype="int16_t[4]"name="pitch">Desired pitch angle in radians +-PI (+-INT16_MAX)</field>
<fieldtype="int16_t[4]"name="yaw">Desired yaw angle in radians, scaled to int16 +-PI (+-INT16_MAX)</field>
<fieldtype="uint16_t[4]"name="thrust">Collective thrust, scaled to uint16 (0..UINT16_MAX)</field>
</message>
<messageid="64"name="STATE_CORRECTION">
<description>Corrects the systems state by adding an error correction term to the position and velocity, and by rotating the attitude by a correction angle.</description>
<fieldtype="float"name="xErr">x position error</field>
<fieldtype="float"name="yErr">y position error</field>
<fieldtype="float"name="zErr">z position error</field>
<description>The filtered global position (e.g. fused GPS and accelerometers). The position is in GPS-frame (right-handed, Z-up). It is designed as scaled integer message since the resolution of float is not sufficient. NOTE: This message is intended for onboard networks / companion computers and higher-bandwidth links and optimized for accuracy and completeness. Please use the GLOBAL_POSITION_INT message for a minimal subset.</description>
<fieldtype="uint32_t"name="time_boot_ms">Timestamp (milliseconds since system boot)</field>
<fieldtype="uint64_t"name="time_utc">Timestamp (microseconds since UNIX epoch) in UTC. 0 for unknown. Commonly filled by the precision time source of a GPS receiver.</field>
<fieldtype="uint8_t"name="estimator_type"enum="MAV_ESTIMATOR_TYPE">Class id of the estimator this estimate originated from.</field>
<fieldtype="int32_t"name="lat">Latitude, expressed as degrees * 1E7</field>
<fieldtype="int32_t"name="lon">Longitude, expressed as degrees * 1E7</field>
<fieldtype="int32_t"name="alt">Altitude in meters, expressed as * 1000 (millimeters), above MSL</field>
<fieldtype="int32_t"name="relative_alt">Altitude above ground in meters, expressed as * 1000 (millimeters)</field>
<fieldtype="float"name="vx">Ground X Speed (Latitude), expressed as m/s</field>
<fieldtype="float"name="vy">Ground Y Speed (Longitude), expressed as m/s</field>
<fieldtype="float"name="vz">Ground Z Speed (Altitude), expressed as m/s</field>
<fieldtype="float[36]"name="covariance">Covariance matrix (first six entries are the first ROW, next six entries are the second row, etc.)</field>
</message>
<messageid="64"name="LOCAL_POSITION_NED_COV">
<description>The filtered local position (e.g. fused computer vision and accelerometers). Coordinate frame is right-handed, Z-axis down (aeronautical frame, NED / north-east-down convention)</description>
<fieldtype="uint32_t"name="time_boot_ms">Timestamp (milliseconds since system boot)</field>
<fieldtype="uint64_t"name="time_utc">Timestamp (microseconds since UNIX epoch) in UTC. 0 for unknown. Commonly filled by the precision time source of a GPS receiver.</field>
<fieldtype="uint8_t"name="estimator_type"enum="MAV_ESTIMATOR_TYPE">Class id of the estimator this estimate originated from.</field>
<fieldtype="float"name="x">X Position</field>
<fieldtype="float"name="y">Y Position</field>
<fieldtype="float"name="z">Z Position</field>
<fieldtype="float"name="vx">X Speed</field>
<fieldtype="float"name="vy">Y Speed</field>
<fieldtype="float"name="vz">Z Speed</field>
<fieldtype="float[36]"name="covariance">Covariance matrix (first six entries are the first ROW, next six entries are the second row, etc.)</field>
</message>
<messageid="65"name="RC_CHANNELS">
<description>The PPM values of the RC channels received. The standard PPM modulation is as follows: 1000 microseconds: 0%, 2000 microseconds: 100%. Individual receivers/transmitters might violate this specification.</description>
@ -1809,6 +1874,24 @@
@@ -1809,6 +1874,24 @@
<fieldtype="uint16_t"name="chan7_raw">RC channel 7 value, in microseconds. A value of UINT16_MAX means to ignore this field.</field>
<fieldtype="uint16_t"name="chan8_raw">RC channel 8 value, in microseconds. A value of UINT16_MAX means to ignore this field.</field>
</message>
<messageid="73"name="MISSION_ITEM_INT">
<description>Message encoding a mission item. This message is emitted to announce
the presence of a mission item and to set a mission item on the system. The mission item can be either in x, y, z meters (type: LOCAL) or x:lat, y:lon, z:altitude. Local frame is Z-down, right handed (NED), global frame is Z-up, right handed (ENU). See alsohttp://qgroundcontrol.org/mavlink/waypoint_protocol.</description>
<fieldtype="uint16_t"name="seq">Waypoint ID (sequence number). Starts at zero. Increases monotonically for each waypoint, no gaps in the sequence (0,1,2,3,4).</field>
<fieldtype="uint8_t"name="frame">The coordinate system of the MISSION. see MAV_FRAME in mavlink_types.h</field>
<fieldtype="uint16_t"name="command">The scheduled action for the MISSION. see MAV_CMD in common.xml MAVLink specs</field>
<fieldtype="uint8_t"name="type_mask">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 6: reserved, bit 7: throttle, bit 8: attitude</field>
<fieldtype="float[4]"name="q">Attitude quaternion (w, x, y, z order, zero-rotation is 1, 0, 0, 0)</field>
<fieldtype="float"name="body_roll_rate">Body roll rate in radians per second</field>
<fieldtype="float"name="body_pitch_rate">Body roll rate in radians per second</field>
<fieldtype="float"name="body_yaw_rate">Body roll rate in radians per second</field>
<fieldtype="float"name="thrust">Collective thrust, normalized to 0 .. 1 (-1 .. 1 for vehicles capable of reverse trust)</field>
</message>
<messageid="83"name="ATTITUDE_TARGET">
<description>Set the vehicle attitude and body angular rates.</description>
<fieldtype="uint32_t"name="time_boot_ms">Timestamp in milliseconds since system boot</field>
<fieldtype="uint8_t"name="type_mask">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</field>
<fieldtype="float[4]"name="q">Attitude quaternion (w, x, y, z order, zero-rotation is 1, 0, 0, 0)</field>
<fieldtype="float"name="body_roll_rate">Body roll rate in radians per second</field>
@ -1867,12 +1968,27 @@
@@ -1867,12 +1968,27 @@
<fieldtype="float"name="body_yaw_rate">Body roll rate in radians per second</field>
<fieldtype="float"name="thrust">Collective thrust, normalized to 0 .. 1 (-1 .. 1 for vehicles capable of reverse trust)</field>
<fieldtype="uint16_t"name="type_mask">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</field>
<fieldtype="float"name="x">X Position in NED frame in meters</field>
<fieldtype="float"name="y">Y Position in NED frame in meters</field>
<fieldtype="float"name="z">Z Position in NED frame in meters (note, altitude is negative in NED)</field>
<fieldtype="float"name="vx">X velocity in NED frame in meter / s</field>
<fieldtype="float"name="vy">Y velocity in NED frame in meter / s</field>
<fieldtype="float"name="vz">Z velocity in NED frame in meter / s</field>
<fieldtype="float"name="afx">X acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N</field>
<fieldtype="float"name="afy">Y acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N</field>
<fieldtype="float"name="afz">Z acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N</field>
</message>
<messageid="85"name="POSITION_TARGET_LOCAL_NED">
<description>Set vehicle position, velocity and acceleration setpoint in local frame.</description>
<fieldtype="uint32_t"name="time_boot_ms">Timestamp in milliseconds since system boot</field>
<fieldtype="uint16_t"name="type_mask">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</field>
<fieldtype="float"name="x">X Position in NED frame in meters</field>
<fieldtype="float"name="y">Y Position in NED frame in meters</field>
@ -1884,15 +2000,31 @@
@@ -1884,15 +2000,31 @@
<fieldtype="float"name="afy">Y acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N</field>
<fieldtype="float"name="afz">Z acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N</field>
<description>Set vehicle position, velocity and acceleration setpoint in the WGS84 coordinate system.</description>
<fieldtype="uint32_t"name="time_boot_ms">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.</field>
<fieldtype="uint16_t"name="type_mask">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</field>
<fieldtype="int32_t"name="lat_int">X Position in WGS84 frame in 1e7 * meters</field>
<fieldtype="int32_t"name="lon_int">Y Position in WGS84 frame in 1e7 * meters</field>
<fieldtype="float"name="alt">Altitude in meters in WGS84 altitude, not AMSL if absolute or relative, above terrain if GLOBAL_TERRAIN_ALT_INT</field>
<fieldtype="float"name="vx">X velocity in NED frame in meter / s</field>
<fieldtype="float"name="vy">Y velocity in NED frame in meter / s</field>
<fieldtype="float"name="vz">Z velocity in NED frame in meter / s</field>
<fieldtype="float"name="afx">X acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N</field>
<fieldtype="float"name="afy">Y acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N</field>
<fieldtype="float"name="afz">Z acceleration or force (if bit 10 of type_mask is set) in NED frame in meter / s^2 or N</field>
</message>
<messageid="87"name="POSITION_TARGET_GLOBAL_INT">
<description>Set vehicle position, velocity and acceleration setpoint in the WGS84 coordinate system.</description>
<fieldtype="uint32_t"name="time_boot_ms">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.</field>
<fieldtype="uint16_t"name="type_mask">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</field>
<fieldtype="int32_t"name="lat_int">X Position in WGS84 frame in 1e7 * meters</field>
<fieldtype="int32_t"name="lon_int">Y Position in WGS84 frame in 1e7 * meters</field>
<fieldtype="float"name="alt">Altitude in WGS84, not AMSL</field>
<fieldtype="float"name="alt">Altitude in meters in WGS84 altitude, not AMSL if absolute or relative, above terrain if GLOBAL_TERRAIN_ALT_INT</field>
<fieldtype="float"name="vx">X velocity in NED frame in meter / s</field>
<fieldtype="float"name="vy">Y velocity in NED frame in meter / s</field>
<fieldtype="float"name="vz">Z velocity in NED frame in meter / s</field>
@ -2086,24 +2218,12 @@
@@ -2086,24 +2218,12 @@
<fieldtype="uint16_t"name="fixed">count of error corrected packets</field>
</message>
<messageid="110"name="FILE_TRANSFER_START">
<description>Begin file transfer</description>
<fieldtype="uint64_t"name="transfer_uid">Unique transfer ID</field>
<fieldtype="uint8_t"name="direction">Transfer direction: 0: from requester, 1: to requester</field>
<fieldtype="uint32_t"name="file_size">File size in bytes</field>
<fieldtype="uint8_t"name="flags">RESERVED</field>
</message>
<messageid="111"name="FILE_TRANSFER_DIR_LIST">
<description>Get directory listing</description>
<fieldtype="uint64_t"name="transfer_uid">Unique transfer ID</field>
<fieldtype="char[240]"name="dir_path">Directory path to list</field>
<fieldtype="uint8_t"name="flags">RESERVED</field>
</message>
<messageid="112"name="FILE_TRANSFER_RES">
<description>File transfer result</description>
<fieldtype="uint64_t"name="transfer_uid">Unique transfer ID</field>
<fieldtype="uint8_t"name="result">0: OK, 1: not permitted, 2: bad path / file name, 3: no space left on device</field>
<messageid="110"name="FILE_TRANSFER_PROTOCOL">
<description>File transfer message</description>
<fieldtype="uint8_t"name="target_network">Network ID (0 for broadcast)</field>
<fieldtype="uint8_t"name="target_system">System ID (0 for broadcast)</field>
<fieldtype="uint8_t"name="target_component">Component ID (0 for broadcast)</field>
<fieldtype="uint8_t[251]"name="payload">Variable length payload. The length is defined by the remaining message length when subtracting the header and other fields. The entire content of this block is opaque unless you understand any the encoding message_type. The particular encoding used can be extension specific and might not always be documented as part of the mavlink specification.</field>
</message>
<messageid="113"name="HIL_GPS">
<description>The global position, as returned by the Global Positioning System (GPS). This is
@ -2328,42 +2448,32 @@
@@ -2328,42 +2448,32 @@
<fieldtype="uint16_t"name="loaded">Number of 4x4 terrain blocks in memory</field>
</message>
<messageid="147"name="BATTERY_STATUS">
<description>Transmitte battery informations for a accu pack.</description>
<fieldtype="uint16_t"name="voltage_cell_1">Battery voltage of cell 1, in millivolts (1 = 1 millivolt)</field>
<fieldtype="uint16_t"name="voltage_cell_2">Battery voltage of cell 2, in millivolts (1 = 1 millivolt), -1: no cell</field>
<fieldtype="uint16_t"name="voltage_cell_3">Battery voltage of cell 3, in millivolts (1 = 1 millivolt), -1: no cell</field>
<fieldtype="uint16_t"name="voltage_cell_4">Battery voltage of cell 4, in millivolts (1 = 1 millivolt), -1: no cell</field>
<fieldtype="uint16_t"name="voltage_cell_5">Battery voltage of cell 5, in millivolts (1 = 1 millivolt), -1: no cell</field>
<fieldtype="uint16_t"name="voltage_cell_6">Battery voltage of cell 6, in millivolts (1 = 1 millivolt), -1: no cell</field>
<description>Battery information</description>
<fieldtype="uint8_t"name="id">Battery ID</field>
<fieldtype="uint8_t"name="function"enum="MAV_BATTERY_FUNCTION">Function of the battery</field>
<fieldtype="uint8_t"name="type"enum="MAV_BATTERY_TYPE">Type (chemistry) of the battery</field>
<fieldtype="int16_t"name="temperature">Temperature of the battery in centi-degrees celsius. INT16_MAX for unknown temperature.</field>
<fieldtype="uint16_t[10]"name="voltages">Battery voltage of cells, in millivolts (1 = 1 millivolt)</field>
<fieldtype="int16_t"name="current_battery">Battery current, in 10*milliamperes (1 = 10 milliampere), -1: autopilot does not measure the current</field>
<fieldtype="int32_t"name="current_consumed">Consumed charge, in milliampere hours (1 = 1 mAh), -1: autopilot does not provide mAh consumption estimate</field>
<fieldtype="int32_t"name="energy_consumed">Consumed energy, in 100*Joules (intergrated U*I*dt) (1 = 100 Joule), -1: autopilot does not provide energy consumption estimate</field>
<fieldtype="int8_t"name="battery_remaining">Remaining battery energy: (0%: 0, 100%: 100), -1: autopilot does not estimate the remaining battery</field>
</message>
<messageid="148"name="SETPOINT_8DOF">
<description>Set the 8 DOF setpoint for a controller.</description>
<fieldtype="float"name="trans_x">Translational Component in x</field>
<fieldtype="float"name="trans_y">Translational Component in y</field>
<fieldtype="float"name="trans_z">Translational Component in z</field>
<fieldtype="float"name="rot_x">Rotational Component in x</field>
<fieldtype="float"name="rot_y">Rotational Component in y</field>
<fieldtype="float"name="rot_z">Rotational Component in z</field>
</message>
<!-- MESSAGE IDs 150 - 240: Space for custom messages in individual projectname_messages.xml files -->
<messageid="148"name="AUTOPILOT_VERSION">
<description>Version and capability of autopilot software</description>
<fieldtype="uint64_t"name="capabilities">bitmask of capabilities (see MAV_PROTOCOL_CAPABILITY enum)</field>
<fieldtype="uint32_t"name="version">Firmware version number</field>
<fieldtype="uint8_t[8]"name="custom_version">Custom version field, commonly the first 8 bytes (16 characters) of the git hash. This is not an unique identifier, but should allow to identify the commit using the main version number even for very large code bases.</field>
</message>
<!-- MESSAGE IDs 180 - 240: Space for custom messages in individual projectname_messages.xml files -->
<messageid="248"name="V2_EXTENSION">
<description>Message implementing parts of the V2 payload specs in V1 frames for transitional support.</description>
<fieldtype="uint8_t"name="target_network">Network ID (0 for broadcast)</field>
<fieldtype="uint8_t"name="target_system">System ID (0 for broadcast)</field>
<fieldtype="uint8_t"name="target_component">Component ID (0 for broadcast)</field>
<fieldtype="uint16_t"name="message_type">A code that identifies the software component that understands this message (analogous to usb device classes or mime type strings). If this code is less than 32768, it is considered a 'registered' protocol extension and the corresponding entry should be added to https://github.com/mavlink/mavlink/extension-message-ids.xml. Software creators can register blocks of message IDs as needed (useful for GCS specific metadata, etc...). Message_types greater than 32767 are considered local experiments and should not be checked in to any widely distributed codebase.</field>
<fieldtype="uint8_t[249]"name="payload">Variable length payload. The length is defined by the remaining message length when subtracting the header and other fields. The entire content of this block is opaque unless you understand any the encoding message_type. The particular encoding used can be extension specific and might not always be documented as part of the mavlink specification.</field>
</message>
<messageid="249"name="MEMORY_VECT">
<description>Send raw controller memory. The use of this message is discouraged for normal packets, but a quite efficient way for testing new messages and getting experimental debug output.</description>
<fieldtype="uint16_t"name="address">Starting address of the debug variables</field>