tf2_client.h
Go to the documentation of this file.
1 #include <mutex>
2 #include <ros/ros.h>
4 
5 namespace tf2_client {
6 
7 typedef std::shared_ptr<tf2_ros::BufferInterface> BufferPtr;
8 
9 BufferPtr get_buffer(ros::NodeHandle &nh, ros::NodeHandle &pnh);
10 
11 }
BufferPtr get_buffer(ros::NodeHandle &nh, ros::NodeHandle &pnh)
Definition: tf2_client.cpp:10
std::shared_ptr< tf2_ros::BufferInterface > BufferPtr
Definition: tf2_client.h:7


tf2_client
Author(s): Tomas Petricek
autogenerated on Sat May 27 2023 02:41:41