#include <stdio.h>#include <stdlib.h>#include <stdint.h>#include <assert.h>#include <stddef.h>#include <version.h>#include <mavlink_types.h>#include <mavlink.h>#include <testsuite.h>
Go to the source code of this file.
Defines | |
| #define | MAVLINK_ASSERT(x) assert(x) |
| #define | MAVLINK_COMM_NUM_BUFFERS 2 |
| #define | MAVLINK_MAX_PAYLOAD_LEN MAVLINK_MAX_DIALECT_PAYLOAD_SIZE |
| #define | MAVLINK_USE_CONVENIENCE_FUNCTIONS |
| #define | PRINT_FORMAT(f, def) (f->print_format?f->print_format:def) |
Functions | |
| static void | comm_send_ch (mavlink_channel_t chan, uint8_t c) |
| int | main (void) |
| static void | print_field (mavlink_message_t *msg, const mavlink_field_info_t *f) |
| static void | print_message (mavlink_message_t *msg) |
| static void | print_one_field (mavlink_message_t *msg, const mavlink_field_info_t *f, int idx) |
Variables | |
| static unsigned | chan_counts [MAVLINK_COMM_NUM_BUFFERS] |
| static unsigned | error_count |
| static mavlink_message_t | last_msg |
| static mavlink_system_t | mavlink_system = {42,11,} |
| static const mavlink_message_info_t | message_info [256] = MAVLINK_MESSAGE_INFO |
| static const unsigned | message_lengths [] = MAVLINK_MESSAGE_LENGTHS |
| #define MAVLINK_ASSERT | ( | x | ) | assert(x) |
| #define MAVLINK_COMM_NUM_BUFFERS 2 |
| #define PRINT_FORMAT | ( | f, | |
| def | |||
| ) | (f->print_format?f->print_format:def) |
| static void comm_send_ch | ( | mavlink_channel_t | chan, |
| uint8_t | c | ||
| ) | [static] |
| static void print_field | ( | mavlink_message_t * | msg, |
| const mavlink_field_info_t * | f | ||
| ) | [static] |
| static void print_message | ( | mavlink_message_t * | msg | ) | [static] |
| static void print_one_field | ( | mavlink_message_t * | msg, |
| const mavlink_field_info_t * | f, | ||
| int | idx | ||
| ) | [static] |
unsigned chan_counts[MAVLINK_COMM_NUM_BUFFERS] [static] |
unsigned error_count [static] |
mavlink_message_t last_msg [static] |
mavlink_system_t mavlink_system = {42,11,} [static] |
const mavlink_message_info_t message_info[256] = MAVLINK_MESSAGE_INFO [static] |
const unsigned message_lengths[] = MAVLINK_MESSAGE_LENGTHS [static] |