

Go to the source code of this file.
| Macros | |
| #define | _MAV_MSG_RETURN_TYPE(TYPE, SIZE) | 
| #define | _MAV_PUT_ARRAY(TYPE, V) | 
| #define | _mav_put_char(buf, wire_offset, b) buf[wire_offset] = b | 
| #define | _mav_put_double(buf, wire_offset, b) byte_swap_8(&buf[wire_offset], (const char *)&b) | 
| #define | _mav_put_float(buf, wire_offset, b) byte_swap_4(&buf[wire_offset], (const char *)&b) | 
| #define | _mav_put_int16_t(buf, wire_offset, b) byte_swap_2(&buf[wire_offset], (const char *)&b) | 
| #define | _mav_put_int32_t(buf, wire_offset, b) byte_swap_4(&buf[wire_offset], (const char *)&b) | 
| #define | _mav_put_int64_t(buf, wire_offset, b) byte_swap_8(&buf[wire_offset], (const char *)&b) | 
| #define | _mav_put_int8_t(buf, wire_offset, b) buf[wire_offset] = (int8_t)b | 
| #define | _mav_put_uint16_t(buf, wire_offset, b) byte_swap_2(&buf[wire_offset], (const char *)&b) | 
| #define | _mav_put_uint32_t(buf, wire_offset, b) byte_swap_4(&buf[wire_offset], (const char *)&b) | 
| #define | _mav_put_uint64_t(buf, wire_offset, b) byte_swap_8(&buf[wire_offset], (const char *)&b) | 
| #define | _mav_put_uint8_t(buf, wire_offset, b) buf[wire_offset] = (uint8_t)b | 
| #define | _MAV_RETURN_ARRAY(TYPE, V) | 
| #define | _MAV_RETURN_char(msg, wire_offset) (char)_MAV_PAYLOAD(msg)[wire_offset] | 
| #define | _MAV_RETURN_int8_t(msg, wire_offset) (int8_t)_MAV_PAYLOAD(msg)[wire_offset] | 
| #define | _MAV_RETURN_uint8_t(msg, wire_offset) (uint8_t)_MAV_PAYLOAD(msg)[wire_offset] | 
| #define | MAVLINK_ASSERT(x) | 
| #define | MAVLINK_AVOID_GCC_STACK_BUG defined(__GNUC__) | 
| #define | MAVLINK_END_UART_SEND(chan, length) | 
| #define | MAVLINK_HELPER static inline | 
| #define | MAVLINK_NEED_BYTE_SWAP (MAVLINK_ENDIAN != MAVLINK_LITTLE_ENDIAN) | 
| #define | MAVLINK_STACK_BUFFER 0 | 
| #define | MAVLINK_START_UART_SEND(chan, length) | 
| Functions | |
| static void | _mav_put_char_array (char *buf, uint8_t wire_offset, const char *b, uint8_t array_length) | 
| static void | _mav_put_int8_t_array (char *buf, uint8_t wire_offset, const int8_t *b, uint8_t array_length) | 
| static void | _mav_put_uint8_t_array (char *buf, uint8_t wire_offset, const uint8_t *b, uint8_t array_length) | 
| static uint16_t | _MAV_RETURN_char_array (const mavlink_message_t *msg, char *value, uint8_t array_length, uint8_t wire_offset) | 
| static uint16_t | _MAV_RETURN_int8_t_array (const mavlink_message_t *msg, int8_t *value, uint8_t array_length, uint8_t wire_offset) | 
| static uint16_t | _MAV_RETURN_uint8_t_array (const mavlink_message_t *msg, uint8_t *value, uint8_t array_length, uint8_t wire_offset) | 
| static void | byte_swap_2 (char *dst, const char *src) | 
| static void | byte_swap_4 (char *dst, const char *src) | 
| static void | byte_swap_8 (char *dst, const char *src) | 
| static void | mav_array_memcpy (void *dest, const void *src, size_t n) | 
| static uint16_t | mavlink_msg_get_send_buffer_length (const mavlink_message_t *msg) | 
| Get the required buffer size for this message.  More... | |
| #define _MAV_MSG_RETURN_TYPE | ( | TYPE, | |
| SIZE | |||
| ) | 
Definition at line 242 of file include_v2.0/protocol.h.
| #define _MAV_PUT_ARRAY | ( | TYPE, | |
| V | |||
| ) | 
Definition at line 208 of file include_v2.0/protocol.h.
| #define _mav_put_char | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | buf[wire_offset] = b | 
Definition at line 137 of file include_v2.0/protocol.h.
| #define _mav_put_double | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | byte_swap_8(&buf[wire_offset], (const char *)&b) | 
Definition at line 147 of file include_v2.0/protocol.h.
| #define _mav_put_float | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | byte_swap_4(&buf[wire_offset], (const char *)&b) | 
Definition at line 146 of file include_v2.0/protocol.h.
| #define _mav_put_int16_t | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | byte_swap_2(&buf[wire_offset], (const char *)&b) | 
Definition at line 141 of file include_v2.0/protocol.h.
| #define _mav_put_int32_t | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | byte_swap_4(&buf[wire_offset], (const char *)&b) | 
Definition at line 143 of file include_v2.0/protocol.h.
| #define _mav_put_int64_t | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | byte_swap_8(&buf[wire_offset], (const char *)&b) | 
Definition at line 145 of file include_v2.0/protocol.h.
| #define _mav_put_int8_t | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | buf[wire_offset] = (int8_t)b | 
Definition at line 136 of file include_v2.0/protocol.h.
| #define _mav_put_uint16_t | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | byte_swap_2(&buf[wire_offset], (const char *)&b) | 
Definition at line 140 of file include_v2.0/protocol.h.
| #define _mav_put_uint32_t | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | byte_swap_4(&buf[wire_offset], (const char *)&b) | 
Definition at line 142 of file include_v2.0/protocol.h.
| #define _mav_put_uint64_t | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | byte_swap_8(&buf[wire_offset], (const char *)&b) | 
Definition at line 144 of file include_v2.0/protocol.h.
| #define _mav_put_uint8_t | ( | buf, | |
| wire_offset, | |||
| b | |||
| ) | buf[wire_offset] = (uint8_t)b | 
Definition at line 135 of file include_v2.0/protocol.h.
| #define _MAV_RETURN_ARRAY | ( | TYPE, | |
| V | |||
| ) | 
Definition at line 305 of file include_v2.0/protocol.h.
| #define _MAV_RETURN_char | ( | msg, | |
| wire_offset | |||
| ) | (char)_MAV_PAYLOAD(msg)[wire_offset] | 
Definition at line 237 of file include_v2.0/protocol.h.
| #define _MAV_RETURN_int8_t | ( | msg, | |
| wire_offset | |||
| ) | (int8_t)_MAV_PAYLOAD(msg)[wire_offset] | 
Definition at line 238 of file include_v2.0/protocol.h.
| #define _MAV_RETURN_uint8_t | ( | msg, | |
| wire_offset | |||
| ) | (uint8_t)_MAV_PAYLOAD(msg)[wire_offset] | 
Definition at line 239 of file include_v2.0/protocol.h.
| #define MAVLINK_ASSERT | ( | x | ) | 
Definition at line 25 of file include_v2.0/protocol.h.
| #define MAVLINK_AVOID_GCC_STACK_BUG defined(__GNUC__) | 
Definition at line 21 of file include_v2.0/protocol.h.
| #define MAVLINK_END_UART_SEND | ( | chan, | |
| length | |||
| ) | 
Definition at line 33 of file include_v2.0/protocol.h.
| #define MAVLINK_HELPER static inline | 
Definition at line 74 of file include_v2.0/protocol.h.
| #define MAVLINK_NEED_BYTE_SWAP (MAVLINK_ENDIAN != MAVLINK_LITTLE_ENDIAN) | 
Definition at line 13 of file include_v2.0/protocol.h.
| #define MAVLINK_STACK_BUFFER 0 | 
Definition at line 17 of file include_v2.0/protocol.h.
| #define MAVLINK_START_UART_SEND | ( | chan, | |
| length | |||
| ) | 
Definition at line 29 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 183 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 201 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 192 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 283 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 297 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 290 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 93 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 98 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 105 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Definition at line 171 of file include_v2.0/protocol.h.
| 
 | inlinestatic | 
Get the required buffer size for this message.
Definition at line 83 of file include_v2.0/protocol.h.