Go to the documentation of this file.00001
00005 #ifndef MAVLINK_H
00006 #define MAVLINK_H
00007
00008 #ifndef MAVLINK_STX
00009 #define MAVLINK_STX 85
00010 #endif
00011
00012 #ifndef MAVLINK_ENDIAN
00013 #define MAVLINK_ENDIAN MAVLINK_BIG_ENDIAN
00014 #endif
00015
00016 #ifndef MAVLINK_ALIGNED_FIELDS
00017 #define MAVLINK_ALIGNED_FIELDS 0
00018 #endif
00019
00020 #ifndef MAVLINK_CRC_EXTRA
00021 #define MAVLINK_CRC_EXTRA 0
00022 #endif
00023
00024 #include "version.h"
00025 #include "test.h"
00026
00027 #endif // MAVLINK_H