59 #ifndef ROSAIC_NODE_HPP 60 #define ROSAIC_NODE_HPP 128 #endif // for ROSAIC_NODE_HPP This class represents the ROsaic node, to be extended..
geometry_msgs::TransformStamped TransformStampedMsg
Highest-Level view on communication services.
void getTransform(const std::string &targetFrame, const std::string &sourceFrame, TransformStampedMsg &T_s_t)
Gets transforms from tf2.
bool getROSParams()
Gets the node parameters from the ROS Parameter Server, parts of which are specified in a YAML file...
Settings settings_
Settings.
io_comm_rx::Comm_IO IO_
Handles communication with the Rx.
geometry_msgs::Quaternion QuaternionMsg
void getRPY(const QuaternionMsg &qm, double &roll, double &pitch, double &yaw)
Gets Euler angles from quaternion message.
This class is the base class for abstraction.
std::unique_ptr< tf2_ros::TransformListener > tfListener_
tf2_ros::Buffer tfBuffer_
tf2 buffer and listener
Handles communication with and configuration of the mosaic (and beyond) receiver(s) ...