44 BufferCore(cache_time)
53 geometry_msgs::TransformStamped
62 geometry_msgs::TransformStamped
64 const std::string& source_frame,
const ros::Time& source_time,
65 const std::string& fixed_frame,
const ros::Duration timeout)
const
67 canTransform(target_frame, target_time, source_frame, source_time, fixed_frame, timeout);
68 return lookupTransform(target_frame, target_time, source_frame, source_time, fixed_frame);
111 std::stringstream ss;
113 <<
" timeout was " << timeout.
toSec() <<
".";
114 (*errstr) += ss.str();
141 bool retval =
canTransform(target_frame, source_frame, time, errstr);
149 const std::string& source_frame,
const ros::Time& source_time,
150 const std::string& fixed_frame,
const ros::Duration timeout, std::string* errstr)
const
165 !
canTransform(target_frame, target_time, source_frame, source_time, fixed_frame) &&
171 bool retval =
canTransform(target_frame, target_time, source_frame, source_time, fixed_frame, errstr);