#include "stdafx.h"#include "stdio.h"#include "stdint.h"#include "stddef.h"#include "assert.h"#include <mavlink_types.h>#include <common/mavlink.h>#include <common/testsuite.h>
Go to the source code of this file.
| Macros | |
| #define | MAVLINK_ASSERT(x) assert(x) | 
| #define | MAVLINK_COMM_NUM_BUFFERS 2 | 
| #define | MAVLINK_USE_CONVENIENCE_FUNCTIONS | 
| #define | PRINT_FORMAT(f, def) (f->print_format?f->print_format:def) | 
| Functions | |
| int | _tmain (int argc, _TCHAR *argv[]) | 
| static void | comm_send_ch (mavlink_channel_t chan, uint8_t c) | 
| 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) | 
Definition at line 17 of file testmav.cpp.
| #define MAVLINK_COMM_NUM_BUFFERS 2 | 
Definition at line 12 of file testmav.cpp.
| #define MAVLINK_USE_CONVENIENCE_FUNCTIONS | 
Definition at line 11 of file testmav.cpp.
| #define PRINT_FORMAT | ( | f, | |
| def | |||
| ) | (f->print_format?f->print_format:def) | 
| int _tmain | ( | int | argc, | 
| _TCHAR * | argv[] | ||
| ) | 
Definition at line 140 of file testmav.cpp.
| 
 | static | 
Definition at line 111 of file testmav.cpp.
| 
 | static | 
Definition at line 72 of file testmav.cpp.
| 
 | static | 
Definition at line 99 of file testmav.cpp.
| 
 | static | 
Definition at line 32 of file testmav.cpp.
| 
 | static | 
Definition at line 25 of file testmav.cpp.
| 
 | static | 
Definition at line 28 of file testmav.cpp.
| 
 | static | 
Definition at line 20 of file testmav.cpp.
| 
 | static | 
Definition at line 15 of file testmav.cpp.
| 
 | static | 
Definition at line 30 of file testmav.cpp.
| 
 | static | 
Definition at line 27 of file testmav.cpp.