15 #include <geometry_msgs/TransformStamped.h>
69 bool ok()
const override;
76 bool canTransform(const ::std::string& target_frame, const ::std::string& source_frame,
77 const ::ros::Time& time, ::
ros::Duration timeout, ::std::string* errstr)
const override;
87 bool canTransform(const ::std::string& target_frame, const ::std::string& source_frame,
90 bool canTransform(const ::std::string& target_frame, const ::ros::Time& target_time,
91 const ::std::string& source_frame, const ::ros::Time& source_time,
93 ::std::string* errstr)
const override;
105 bool canTransform(const ::std::string& target_frame, const ::ros::Time& target_time,
106 const ::std::string& source_frame, const ::ros::Time& source_time,
107 const ::std::string& fixed_frame, ::
ros::Duration timeout)
const;
110 const ::std::string& target_frame, const ::std::string& source_frame,
111 const ::ros::Time& time, const ::ros::Duration timeout)
const override;
114 const ::std::string& target_frame, const ::ros::Time& target_time,
115 const ::std::string& source_frame, const ::ros::Time& source_time,
116 const ::std::string& fixed_frame, const ::ros::Duration timeout)
const override;
161 return ::tf2_ros::Buffer::transform(in, out, target_frame, timeout);
179 return ::tf2_ros::Buffer::transform(in, target_frame, timeout);
199 template <
class A,
class B>
202 return ::tf2_ros::Buffer::transform(in, out, target_frame, timeout);
221 T&
transform(
const T& in, T& out, const ::std::string& target_frame, const ::ros::Time& target_time,
222 const ::std::string& fixed_frame, ::
ros::Duration timeout = {0, 0})
const
224 return ::tf2_ros::Buffer::transform(in, out, target_frame, target_time, fixed_frame, timeout);
244 T
transform(
const T& in, const ::std::string& target_frame, const ::ros::Time& target_time,
245 const ::std::string& fixed_frame, ::
ros::Duration timeout = {0, 0})
const
247 return ::tf2_ros::Buffer::transform(in, target_frame, target_time, fixed_frame, timeout);
271 template <
class A,
class B>
272 B&
transform(
const A& in, B& out, const ::std::string& target_frame, const ::ros::Time& target_time,
273 const ::std::string& fixed_frame, ::
ros::Duration timeout = {0, 0})
const
275 return ::tf2_ros::Buffer::transform(in, out, target_frame, target_time, fixed_frame, timeout);
298 bool setTransform(const ::geometry_msgs::TransformStamped&
transform, const ::std::string& authority,
299 bool is_static =
false);
310 ::geometry_msgs::TransformStamped
lookupTransform(const ::std::string& target_frame,
311 const ::std::string& source_frame, const ::ros::Time& time)
const;
324 ::geometry_msgs::TransformStamped
lookupTransform(const ::std::string& target_frame, const ::ros::Time& target_time,
325 const ::std::string& source_frame, const ::ros::Time& source_time, const ::std::string& fixed_frame)
const;
335 bool canTransform(const ::std::string& target_frame, const ::std::string& source_frame, const ::ros::Time& time,
336 ::std::string* error_msg =
nullptr)
const;
348 bool canTransform(const ::std::string& target_frame, const ::ros::Time& target_time,
349 const ::std::string& source_frame, const ::ros::Time& source_time, const ::std::string& fixed_frame,
350 ::std::string* error_msg =
nullptr)
const;