Go to the documentation of this file.
33 #ifndef TF2_ROS_BUFFER_H
34 #define TF2_ROS_BUFFER_H
36 #include <tf2_ros/buffer_interface.h>
37 #include <tf2/buffer_core.h>
38 #include <tf2_msgs/FrameGraph.h>
40 #include <tf2/convert.h>
94 const std::string& source_frame,
const ros::Time& source_time,
122 const std::string& source_frame,
const ros::Time& source_time,
129 bool getFrames(tf2_msgs::FrameGraph::Request& req, tf2_msgs::FrameGraph::Response& res) ;
140 static const std::string
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.";
145 #endif // TF2_ROS_BUFFER_H
geometry_msgs::TransformStamped lookupTransform(const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time, const std::string &fixed_frame) const
ros::ServiceServer frames_server_
virtual bool canTransform(const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time, const std::string &fixed_frame, const ros::Duration timeout, std::string *errstr=NULL) const
static const std::string threading_error
Buffer(ros::Duration cache_time=ros::Duration(BufferCore::DEFAULT_CACHE_TIME), bool debug=false)
bool canTransform(const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time, const std::string &fixed_frame, std::string *error_msg=NULL) const
bool getFrames(tf2_msgs::FrameGraph::Request &req, tf2_msgs::FrameGraph::Response &res)
A Class which provides coordinate transforms between any two frames in a system.
bool checkAndErrorDedicatedThreadPresent(std::string *errstr) const
virtual geometry_msgs::TransformStamped lookupTransform(const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time, const std::string &fixed_frame, const ros::Duration timeout) const
sick_scan_xd
Author(s): Michael Lehning
, Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:07