#include "sick_scan/sick_scan_base.h"
#include <tf2_ros/buffer_interface.h>
#include <tf2/buffer_core.h>
#include <tf2_msgs/FrameGraph.h>
#include <ros/ros.h>
#include <tf2/convert.h>
Go to the source code of this file.
|
static const std::string | tf2_ros::threading_error = "Do not call canTransform or lookupTransform with a timeout unless you are using another thread for populating data. Without a dedicated thread it will always timeout. If you have a seperate thread servicing tf messages, call setUsingDedicatedThread(true) on your Buffer instance." |
|
◆ TF2_ROS_BUFFER_H
- Author
- Wim Meeussen
Definition at line 34 of file buffer.h.