35 #ifndef NAV_2D_UTILS__TF_HELP_HPP_
36 #define NAV_2D_UTILS__TF_HELP_HPP_
40 #include "tf2_ros/buffer.h"
41 #include "nav_2d_utils/conversions.hpp"
42 #include "geometry_msgs/msg/pose_stamped.hpp"
43 #include "nav_2d_msgs/msg/pose2_d_stamped.hpp"
44 #include "tf2_geometry_msgs/tf2_geometry_msgs.hpp"
46 namespace nav_2d_utils
59 const std::shared_ptr<tf2_ros::Buffer> tf,
60 const std::string frame,
61 const geometry_msgs::msg::PoseStamped & in_pose,
62 geometry_msgs::msg::PoseStamped & out_pose,
63 rclcpp::Duration & transform_tolerance
77 const std::shared_ptr<tf2_ros::Buffer> tf,
78 const std::string frame,
79 const nav_2d_msgs::msg::Pose2DStamped & in_pose,
80 nav_2d_msgs::msg::Pose2DStamped & out_pose,
81 rclcpp::Duration & transform_tolerance