Function nav_2d_utils::transformPose(const std::shared_ptr<tf2_ros::Buffer>, const std::string, const nav_2d_msgs::msg::Pose2DStamped&, nav_2d_msgs::msg::Pose2DStamped&, rclcpp::Duration&)
Defined in File tf_help.hpp
Function Documentation
-
bool nav_2d_utils::transformPose(const std::shared_ptr<tf2_ros::Buffer> tf, const std::string frame, const nav_2d_msgs::msg::Pose2DStamped &in_pose, nav_2d_msgs::msg::Pose2DStamped &out_pose, rclcpp::Duration &transform_tolerance)
Transform a Pose2DStamped from one frame to another while catching exceptions.
Also returns immediately if the frames are equal.
- Parameters:
tf – Smart pointer to TFListener
frame – Frame to transform the pose into
in_pose – Pose to transform
out_pose – Place to store the resulting transformed pose
- Returns:
True if successful transform