41 #ifndef MBF_UTILITY__NAVIGATION_UTILITY_H_ 42 #define MBF_UTILITY__NAVIGATION_UTILITY_H_ 44 #include <geometry_msgs/PoseStamped.h> 70 const std::string &target_frame,
73 const geometry_msgs::PointStamped &in,
74 const std::string &fixed_frame,
75 geometry_msgs::PointStamped &out);
89 const std::string &target_frame,
92 const geometry_msgs::PoseStamped &in,
93 const std::string &fixed_frame,
94 geometry_msgs::PoseStamped &out);
106 const std::string &robot_frame,
107 const std::string &global_frame,
109 geometry_msgs::PoseStamped &robot_pose);
116 double distance(
const geometry_msgs::PoseStamped &pose1,
const geometry_msgs::PoseStamped &pose2);
124 double angle(
const geometry_msgs::PoseStamped &pose1,
const geometry_msgs::PoseStamped &pose2);
double angle(const geometry_msgs::PoseStamped &pose1, const geometry_msgs::PoseStamped &pose2)
computes the smallest angle between two poses.
bool getRobotPose(const TF &tf, const std::string &robot_frame, const std::string &global_frame, const ros::Duration &timeout, geometry_msgs::PoseStamped &robot_pose)
Computes the robot pose.
double distance(const geometry_msgs::PoseStamped &pose1, const geometry_msgs::PoseStamped &pose2)
Computes the Euclidean-distance between two poses.
bool transformPoint(const TF &tf, const std::string &target_frame, const ros::Time &target_time, const ros::Duration &timeout, const geometry_msgs::PointStamped &in, const std::string &fixed_frame, geometry_msgs::PointStamped &out)
Transforms a point from one frame into another.
bool transformPose(const TF &tf, const std::string &target_frame, const ros::Time &target_time, const ros::Duration &timeout, const geometry_msgs::PoseStamped &in, const std::string &fixed_frame, geometry_msgs::PoseStamped &out)
Transforms a pose from one frame into another.