37 #ifndef MAVROSFLIGHT_MAVLINK_COMM_H    38 #define MAVROSFLIGHT_MAVLINK_COMM_H    43 #include <boost/asio.hpp>    44 #include <boost/function.hpp>    45 #include <boost/thread.hpp>    53 #define MAVLINK_SERIAL_READ_BUF_SIZE 256   104   virtual void do_async_read(
const boost::asio::mutable_buffers_1 &buffer,
   105                              boost::function<
void(
const boost::system::error_code &, 
size_t)> handler) = 0;
   106   virtual void do_async_write(
const boost::asio::const_buffers_1 &buffer,
   107                               boost::function<
void(
const boost::system::error_code &, 
size_t)> handler) = 0;
   130       memcpy(data, buf, len);
   133     const uint8_t *
dpos()
 const { 
return data + 
pos; }
   141   typedef boost::lock_guard<boost::recursive_mutex> 
mutex_lock;
   157   void async_read_end(
const boost::system::error_code &error, 
size_t bytes_transferred);
   170   void async_write_end(
const boost::system::error_code &error, 
size_t bytes_transferred);
   195 #endif // MAVROSFLIGHT_MAVLINK_COMM_H void async_read()
Initiate an asynchronous read operation. 
boost::asio::io_service io_service_
boost io service provider 
void async_read_end(const boost::system::error_code &error, size_t bytes_transferred)
Handler for end of asynchronous read operation. 
uint8_t read_buf_raw_[MAVLINK_SERIAL_READ_BUF_SIZE]
Describes an interface classes can implement to receive and handle mavlink messages. 
bool write_in_progress_
flag for whether async_write is already running 
std::vector< MavlinkListenerInterface * > listeners_
listeners for mavlink messages 
void close()
Stops communication and closes the port. 
mavlink_message_t msg_in_
boost::lock_guard< boost::recursive_mutex > mutex_lock
Convenience typedef for mutex lock. 
boost::thread io_thread_
thread on which the io service runs 
void register_mavlink_listener(MavlinkListenerInterface *const listener)
Register a listener for mavlink messages. 
mavlink_status_t status_in_
uint8_t data[MAVLINK_MAX_PACKET_LEN]
void open()
Opens the port and begins communication. 
void unregister_mavlink_listener(MavlinkListenerInterface *const listener)
Unregister a listener for mavlink messages. 
const uint8_t * dpos() const 
#define MAVLINK_MAX_PACKET_LEN
Maximum packet length. 
virtual void do_async_read(const boost::asio::mutable_buffers_1 &buffer, boost::function< void(const boost::system::error_code &, size_t)> handler)=0
std::list< WriteBuffer * > write_queue_
queue of buffers to be written to the serial port 
MavlinkComm()
Instantiates the class and begins communication on the specified serial port. 
#define MAVLINK_SERIAL_READ_BUF_SIZE
void async_write_end(const boost::system::error_code &error, size_t bytes_transferred)
Handler for end of asynchronous write operation. 
~MavlinkComm()
Stops communication and closes the serial port before the object is destroyed. 
virtual void do_close()=0
boost::recursive_mutex mutex_
mutex for threadsafe operation 
Struct for buffering the contents of a mavlink message. 
void async_write(bool check_write_state)
Initialize an asynchronous write operation. 
WriteBuffer(const uint8_t *buf, uint16_t len)
virtual void do_async_write(const boost::asio::const_buffers_1 &buffer, boost::function< void(const boost::system::error_code &, size_t)> handler)=0
void send_message(const mavlink_message_t &msg)
Send a mavlink message.