37 #ifndef TF2_ROS_BUFFER_CLIENT_H_
38 #define TF2_ROS_BUFFER_CLIENT_H_
42 #include <tf2_msgs/LookupTransformAction.h>
52 class BufferClient :
public BufferInterface
74 virtual geometry_msgs::TransformStamped
75 lookupTransform(
const std::string& target_frame,
const std::string& source_frame,
90 virtual geometry_msgs::TransformStamped
92 const std::string& source_frame,
const ros::Time& source_time,
104 canTransform(
const std::string& target_frame,
const std::string& source_frame,
119 const std::string& source_frame,
const ros::Time& source_time,
132 geometry_msgs::TransformStamped
processGoal(
const tf2_msgs::LookupTransformGoal& goal)
const;
133 geometry_msgs::TransformStamped
processResult(
const tf2_msgs::LookupTransformResult& result)
const;