MAVConn mavlink.h selector. More...
#include <mavlink/v1.0/mavlink_types.h>
#include <mavlink/v1.0/common/mavlink.h>
Go to the source code of this file.
Defines | |
#define | _DIALECT(name) _DIALECT_CONCAT(name) |
#define | _DIALECT_ardupilotmega 1 |
#define | _DIALECT_ASLUAV 11 |
#define | _DIALECT_autoquad 2 |
#define | _DIALECT_common 3 |
#define | _DIALECT_CONCAT(name) _DIALECT_ ## name |
#define | _DIALECT_matrixpilot 4 |
#define | _DIALECT_minimal 5 |
#define | _DIALECT_paparazzi 12 |
#define | _DIALECT_pixhawk 6 /* removed */ |
#define | _DIALECT_sensesoar 10 /* removed */ |
#define | _DIALECT_slugs 7 |
#define | _DIALECT_test 8 |
#define | _DIALECT_ualberta 9 |
#define | MAVLINK_DIALECT common |
#define | MAVLINK_GET_CHANNEL_BUFFER |
#define | MAVLINK_GET_CHANNEL_STATUS |
Functions | |
mavlink_message_t * | mavlink_get_channel_buffer (uint8_t chan) |
mavlink_status_t * | mavlink_get_channel_status (uint8_t chan) |
MAVConn mavlink.h selector.
Definition in file mavlink_dialect.h.