Defines | Functions | Variables
testmav.c File Reference
#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>
Include dependency graph for testmav.c:

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 Documentation

#define MAVLINK_ASSERT (   x)    assert(x)

Definition at line 21 of file testmav.c.

#define MAVLINK_COMM_NUM_BUFFERS   2

Definition at line 11 of file testmav.c.

Definition at line 16 of file testmav.c.

Definition at line 10 of file testmav.c.

#define PRINT_FORMAT (   f,
  def 
)    (f->print_format?f->print_format:def)

Function Documentation

static void comm_send_ch ( mavlink_channel_t  chan,
uint8_t  c 
) [static]

Definition at line 115 of file testmav.c.

int main ( void  )

Definition at line 144 of file testmav.c.

static void print_field ( mavlink_message_t msg,
const mavlink_field_info_t f 
) [static]

Definition at line 76 of file testmav.c.

static void print_message ( mavlink_message_t msg) [static]

Definition at line 103 of file testmav.c.

static void print_one_field ( mavlink_message_t msg,
const mavlink_field_info_t f,
int  idx 
) [static]

Definition at line 36 of file testmav.c.


Variable Documentation

Definition at line 29 of file testmav.c.

unsigned error_count [static]

Definition at line 32 of file testmav.c.

Definition at line 24 of file testmav.c.

mavlink_system_t mavlink_system = {42,11,} [static]

Definition at line 19 of file testmav.c.

const mavlink_message_info_t message_info[256] = MAVLINK_MESSAGE_INFO [static]

Definition at line 34 of file testmav.c.

const unsigned message_lengths[] = MAVLINK_MESSAGE_LENGTHS [static]

Definition at line 31 of file testmav.c.



mavlink
Author(s): Lorenz Meier
autogenerated on Wed Sep 9 2015 18:06:18