#include <stdio.h>
#include <stdlib.h>
#include <stdint.h>
#include <assert.h>
#include <stddef.h>
#include <stdbool.h>
#include <version.h>
#include <mavlink_types.h>
#include <mavlink.h>
#include <testsuite.h>
Go to the source code of this file.
#define MAVLINK_ASSERT | ( | x | ) | assert(x) |
#define MAVLINK_COMM_NUM_BUFFERS 2 |
#define mavlink_expected_message_length | ( | msg | ) | message_lengths[(msg)->msgid] |
#define mavlink_get_message_info | ( | msg | ) | &message_info[(msg)->msgid] |
#define MAVLINK_USE_MESSAGE_INFO |
#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[] = MAVLINK_MESSAGE_INFO [static] |
const uint8_t message_lengths[] = MAVLINK_MESSAGE_LENGTHS [static] |