tf2_ros  master
This package contains the ROS bindings for the tf2 library, for both Python and C++.
Public Member Functions | List of all members
tf2_ros::TransformListener Class Reference

This class provides an easy way to request and receive coordinate frame transform information. More...

#include <transform_listener.h>

Public Member Functions

TF2_ROS_PUBLIC TransformListener (tf2::BufferCore &buffer, bool spin_thread=true)
 Constructor for transform listener. More...
 
template<class NodeT , class AllocatorT = std::allocator<void>>
 TransformListener (tf2::BufferCore &buffer, NodeT &&node, bool spin_thread=true, const rclcpp::QoS &qos=DynamicListenerQoS(), const rclcpp::QoS &static_qos=StaticListenerQoS(), const rclcpp::SubscriptionOptionsWithAllocator< AllocatorT > &options=rclcpp::SubscriptionOptionsWithAllocator< AllocatorT >())
 
virtual TF2_ROS_PUBLIC ~TransformListener ()
 

Detailed Description

This class provides an easy way to request and receive coordinate frame transform information.

Constructor & Destructor Documentation

◆ TransformListener() [1/2]

TF2_ROS_PUBLIC tf2_ros::TransformListener::TransformListener ( tf2::BufferCore &  buffer,
bool  spin_thread = true 
)
explicit

Constructor for transform listener.

◆ TransformListener() [2/2]

template<class NodeT , class AllocatorT = std::allocator<void>>
tf2_ros::TransformListener::TransformListener ( tf2::BufferCore &  buffer,
NodeT &&  node,
bool  spin_thread = true,
const rclcpp::QoS &  qos = DynamicListenerQoS(),
const rclcpp::QoS &  static_qos = StaticListenerQoS(),
const rclcpp::SubscriptionOptionsWithAllocator< AllocatorT > &  options = rclcpp::SubscriptionOptionsWithAllocator<AllocatorT>() 
)
inline

◆ ~TransformListener()

virtual TF2_ROS_PUBLIC tf2_ros::TransformListener::~TransformListener ( )
virtual

The documentation for this class was generated from the following file: