19 #ifndef TRANSFORM_HELPERS_HPP    20 #define TRANSFORM_HELPERS_HPP    22 #include <geometry_msgs/Transform.h>    23 #include <geometry_msgs/Pose.h>    33 inline double getYaw(
const geometry_msgs::Pose& pose)
    35   double yaw, _pitch, _roll;
    37                                 pose.orientation.z, pose.orientation.w)).
getEulerYPR(yaw, _pitch, _roll);
    41 inline double getYaw( 
const geometry_msgs::Transform& pose)
    43   double yaw, _pitch, _roll;
 
void getEulerYPR(tf2Scalar &yaw, tf2Scalar &pitch, tf2Scalar &roll, unsigned int solution_number=1) const