Go to the documentation of this file.
89 ROSaicNode(
const rclcpp::NodeOptions& options);
116 const std::string& sourceFrame,
io::CommunicationCore IO_
Handles communication with the Rx.
Highest-Level view on communication services.
This class represents the ROsaic node, to be extended..
void getTransform(const std::string &targetFrame, const std::string &sourceFrame, TransformStampedMsg &T_s_t) const
Gets transforms from tf2.
geometry_msgs::msg::Quaternion QuaternionMsg
bool validPeriod(uint32_t period, bool isIns) const
Checks if the period has a valid value.
std::unique_ptr< tf2_ros::TransformListener > tfListener_
This class is the base class for abstraction.
void sendVelocity(const std::string &velNmea)
Send velocity to communication layer (virtual)
bool isIns()
Check if Rx is INS.
bool getROSParams()
Gets the node parameters from the ROS Parameter Server, parts of which are specified in a YAML file.
geometry_msgs::msg::TransformStamped TransformStampedMsg
void getRPY(const QuaternionMsg &qm, double &roll, double &pitch, double &yaw) const
Gets Euler angles from quaternion message.
Handles communication with and configuration of the mosaic (and beyond) receiver(s)
tf2_ros::Buffer tfBuffer_
tf2 buffer and listener