22 #include <boost/shared_ptr.hpp> 23 #include <eigen3/Eigen/Geometry> 25 #include "geometry_msgs/Pose.h" 35 return Eigen::Quaterniond(pose.orientation.w, pose.orientation.x, pose.orientation.y, pose.orientation.z);
48 bool checkPosesAreApproxEquale(
const geometry_msgs::Pose &pose1,
const geometry_msgs::Pose &pose2,
const double position_threshold,
const double orientation_rad_threshold);
static void resetInstance()
bool checkOrientationsAreApproxEquale(const geometry_msgs::Pose &pose1, const geometry_msgs::Pose &pose2, const double orientation_rad_threshold)
static boost::shared_ptr< PoseHelper > getInstance()
double calcDistancePositionEucl(const geometry_msgs::Pose &pose1, const geometry_msgs::Pose &pose2)
static boost::shared_ptr< PoseHelper > instance_ptr_
Eigen::Quaterniond convertPoseQuatToQuat(const geometry_msgs::Pose &pose)
bool checkPositionsAreApproxEquale(const geometry_msgs::Pose &pose1, const geometry_msgs::Pose &pose2, const double position_threshold)
bool checkPosesAreApproxEquale(const geometry_msgs::Pose &pose1, const geometry_msgs::Pose &pose2, const double position_threshold, const double orientation_rad_threshold)
boost::shared_ptr< PoseHelper > PoseHelperPtr
double calcAngularDistanceInRad(const geometry_msgs::Pose &pose1, const geometry_msgs::Pose &pose2)