Function nav2_util::getTransform(const std::string&, const std::string&, const tf2::Duration&, const std::shared_ptr<tf2_ros::Buffer>, tf2::Transform&)
Defined in File robot_utils.hpp
Function Documentation
-
bool nav2_util::getTransform(const std::string &source_frame_id, const std::string &target_frame_id, const tf2::Duration &transform_tolerance, const std::shared_ptr<tf2_ros::Buffer> tf_buffer, tf2::Transform &tf2_transform)
Obtains a transform from source_frame_id at source_time -> to target_frame_id at target_time time.
Obtains a transform from source_frame_id -> to target_frame_id
- Parameters:
source_frame_id – Source frame ID to convert from
source_time – Source timestamp to convert from
target_frame_id – Target frame ID to convert to
target_time – Target time to interpolate to
transform_tolerance – Transform tolerance
tf_transform – Output source->target transform
source_frame_id – Source frame ID to convert from
target_frame_id – Target frame ID to convert to
transform_tolerance – Transform tolerance
tf_buffer – TF buffer to use for the transformation
tf_transform – Output source->target transform
- Returns:
True if got correct transform, otherwise false
- Returns:
True if got correct transform, otherwise false