6#ifndef YARP_DEV_FRAMETRANSFORMSETNWCROS2_H
7#define YARP_DEV_FRAMETRANSFORMSETNWCROS2_H
16#include <rclcpp/rclcpp.hpp>
17#include <tf2_msgs/msg/tf_message.hpp>
18#include <geometry_msgs/msg/quaternion.hpp>
19#include <geometry_msgs/msg/transform.hpp>
20#include <geometry_msgs/msg/vector3.hpp>
21#include <geometry_msgs/msg/transform_stamped.hpp>
22#include <std_msgs/msg/header.hpp>
66 bool close()
override;
79 void ros2TimeFromYarp(
double yarpTime, builtin_interfaces::msg::Time& ros2Time);
83 mutable std::mutex m_trf_mutex;
84 rclcpp::Publisher<tf2_msgs::msg::TFMessage>::SharedPtr m_publisherFtTimed;
85 rclcpp::Publisher<tf2_msgs::msg::TFMessage>::SharedPtr m_publisherFtStatic;
87 rclcpp::Node::SharedPtr m_node;
contains the definition of a Vector type
Interface implemented by all device drivers.
An abstraction for a periodic thread.
A base class for nested structures that can be searched.