Classes | Namespaces | Macros | Typedefs | Functions
message.hpp File Reference
#include <array>
#include <cassert>
#include <cstring>
#include <sstream>
#include <string>
#include <iostream>
#include "mavlink_types.h"
#include "mavlink_helpers.h"
#include "msgmap.hpp"
Include dependency graph for message.hpp:

Go to the source code of this file.

Classes

struct  mavlink::Message::Info
 
struct  mavlink::Message
 

Namespaces

 

Macros

#define _MAVLINK_CONVERSIONS_H_
 
#define MAVLINK_GET_MSG_ENTRY
 
#define MAVLINK_HELPER   static inline
 
#define MAVLINK_USE_CXX_NAMESPACE
 

Typedefs

using mavlink::msgid_t = uint32_t
 Message ID type. More...
 

Functions

const mavlink_msg_entry_tmavlink::mavlink_get_msg_entry (uint32_t msgid)
 
template<size_t _N>
void mavlink::set_string (std::array< char, _N > &a, const std::string &s)
 
template<size_t _N>
void mavlink::set_string_z (std::array< char, _N > &a, const std::string &s)
 
template<size_t _N>
std::string mavlink::to_string (const std::array< char, _N > &a)
 
template<typename _T , size_t _N>
std::string mavlink::to_string (const std::array< _T, _N > &a)
 

Macro Definition Documentation

#define _MAVLINK_CONVERSIONS_H_

Definition at line 18 of file message.hpp.

#define MAVLINK_GET_MSG_ENTRY

Definition at line 19 of file message.hpp.

#define MAVLINK_HELPER   static inline

Definition at line 12 of file message.hpp.

#define MAVLINK_USE_CXX_NAMESPACE

Definition at line 15 of file message.hpp.



mavlink
Author(s): Lorenz Meier
autogenerated on Sun Apr 7 2019 02:06:02