ROSaic
Data Structures | Namespaces | Variables
callbackhandlers.hpp File Reference

Handles callbacks when reading in various NMEA messages and/or SBF blocks. More...

#include <boost/foreach.hpp>
#include <boost/function.hpp>
#include <boost/thread.hpp>
#include <boost/thread/condition.hpp>
#include <boost/tokenizer.hpp>
#include <boost/algorithm/string/join.hpp>
#include <boost/date_time/posix_time/posix_time.hpp>
#include <boost/asio.hpp>
#include <boost/bind.hpp>
#include <boost/format.hpp>
#include <boost/asio/serial_port.hpp>
#include <boost/thread/mutex.hpp>
#include <rosaic/communication/mosaicMessage.hpp>
Include dependency graph for callbackhandlers.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Data Structures

class  io_comm_mosaic::AbstractCallbackHandler
 
class  io_comm_mosaic::CallbackHandler< T >
 Abstract class representing a generic callback handler, includes high-level functionality such as wait. More...
 
class  io_comm_mosaic::CallbackHandlers
 Represents ensemble of (to be constructed) ROS messages, to be handled at once by this class. More...
 

Namespaces

 io_comm_mosaic
 

Variables

bool publish_navsatfix
 Whether or not to publish the sensor_msgs::NavSatFix message. More...
 
bool publish_gpsfix
 Whether or not to publish the gps_common::GPSFix message. More...
 
bool publish_gpst
 Whether or not to publish the sensor_msgs::TimeReference message with GPST. More...
 
bool publish_posewithcovariancestamped
 Whether or not to publish the geometry_msgs::PoseWithCovarianceStamped message. More...
 
bool response_received
 Determines whether a command reply was received from mosaic. More...
 
boost::mutex response_mutex
 Mutex to control changes of global variable "response_received". More...
 
boost::condition_variable response_condition
 Condition variable complementing "response_mutex". More...
 
bool cd_received
 Determines whether the connection descriptor was received from mosaic. More...
 
boost::mutex cd_mutex
 Mutex to control changes of global variable "cd_received". More...
 
boost::condition_variable cd_condition
 Condition variable complementing "cd_mutex". More...
 
uint32_t cd_count
 Since after SSSSSSSSSSS we need to wait for second connection descriptor, we have to count the connection descriptors. More...
 
std::string mosaic_tcp_port
 Mosaic TCP port, e.g. IP10 or IP11, to which ROSaic is connected to. More...
 

Detailed Description

Handles callbacks when reading in various NMEA messages and/or SBF blocks.

Date
22/08/20

Definition in file callbackhandlers.hpp.

Variable Documentation

◆ cd_condition

boost::condition_variable cd_condition

Condition variable complementing "cd_mutex".

Definition at line 634 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::ConfigureMosaic(), and io_comm_mosaic::CallbackHandlers::ReadCallback().

◆ cd_count

uint32_t cd_count

Since after SSSSSSSSSSS we need to wait for second connection descriptor, we have to count the connection descriptors.

Definition at line 640 of file rosaic_node.cpp.

Referenced by io_comm_mosaic::CallbackHandlers::ReadCallback().

◆ cd_mutex

boost::mutex cd_mutex

Mutex to control changes of global variable "cd_received".

Definition at line 630 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::ConfigureMosaic(), and io_comm_mosaic::CallbackHandlers::ReadCallback().

◆ cd_received

bool cd_received

Determines whether the connection descriptor was received from mosaic.

Definition at line 632 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::ConfigureMosaic(), main(), and io_comm_mosaic::CallbackHandlers::ReadCallback().

◆ mosaic_tcp_port

std::string mosaic_tcp_port

Mosaic TCP port, e.g. IP10 or IP11, to which ROSaic is connected to.

Definition at line 638 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::ConfigureMosaic(), and io_comm_mosaic::CallbackHandlers::ReadCallback().

◆ publish_gpsfix

bool publish_gpsfix

Whether or not to publish the gps_common::GPSFix message.

Definition at line 613 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::ConfigureMosaic(), rosaic_node::ROSaicNode::DefineMessages(), io_comm_mosaic::CallbackHandlers::Handle(), and main().

◆ publish_gpst

bool publish_gpst

Whether or not to publish the sensor_msgs::TimeReference message with GPST.

Definition at line 609 of file rosaic_node.cpp.

Referenced by io_comm_mosaic::CallbackHandlers::Handle().

◆ publish_navsatfix

bool publish_navsatfix

Whether or not to publish the sensor_msgs::NavSatFix message.

Definition at line 611 of file rosaic_node.cpp.

Referenced by io_comm_mosaic::CallbackHandlers::Handle().

◆ publish_posewithcovariancestamped

bool publish_posewithcovariancestamped

Whether or not to publish the geometry_msgs::PoseWithCovarianceStamped message.

Definition at line 615 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::DefineMessages(), io_comm_mosaic::CallbackHandlers::Handle(), and main().

◆ response_condition

boost::condition_variable response_condition

Condition variable complementing "response_mutex".

Definition at line 628 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::ConfigureMosaic(), and io_comm_mosaic::CallbackHandlers::ReadCallback().

◆ response_mutex

boost::mutex response_mutex

Mutex to control changes of global variable "response_received".

Definition at line 624 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::ConfigureMosaic(), and io_comm_mosaic::CallbackHandlers::ReadCallback().

◆ response_received

bool response_received

Determines whether a command reply was received from mosaic.

Definition at line 626 of file rosaic_node.cpp.

Referenced by rosaic_node::ROSaicNode::ConfigureMosaic(), main(), and io_comm_mosaic::CallbackHandlers::ReadCallback().