6#ifndef YARP_DEV_FRAMETRANSFORMGETNWCROS2_H
7#define YARP_DEV_FRAMETRANSFORMGETNWCROS2_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>
29#define ROS2NODENAME "tfNodeGet"
30#define ROS2TOPICNAME_TF "/tf"
31#define ROS2TOPICNAME_TF_STATIC "/tf_static"
71 bool close()
override;
77 bool getTransforms(std::vector<yarp::math::FrameTransform>& transforms)
const override;
85 bool updateBuffer(
const std::vector<geometry_msgs::msg::TransformStamped>& transforms,
bool areStatic);
89 mutable std::mutex m_trf_mutex;
90 rclcpp::Subscription<tf2_msgs::msg::TFMessage>::SharedPtr m_subscriptionFtTimed;
91 rclcpp::Subscription<tf2_msgs::msg::TFMessage>::SharedPtr m_subscriptionFtStatic;
92 rclcpp::Node::SharedPtr m_node;
contains the definition of a Vector type
Interface implemented by all device drivers.
A base class for nested structures that can be searched.