39 mInitPosePub = mNodeHandle->advertise<geometry_msgs::PoseWithCovarianceStamped>(
"/initialpose", 100,
false);
41 this->silent = silent;
45 tf::Quaternion q(initialPose.orientation.x, initialPose.orientation.y, initialPose.orientation.z, initialPose.orientation.w);
47 double yaw, pitch, roll;
48 m.
getRPY(roll, pitch, yaw);
60 std::cout <<
"Press ENTER to continue.." << std::endl <<
">";
61 std::getline(std::cin, dummy);
62 std::cout << std::endl;
70 Eigen::AngleAxis<Precision> rollAngle(M_PI*roll/180.0,SimpleVector3::UnitX());
71 Eigen::AngleAxis<Precision> pitchAngle(M_PI*pitch/180.0,SimpleVector3::UnitY());
72 Eigen::AngleAxis<Precision> yawAngle(M_PI*yaw/180.0,SimpleVector3::UnitZ());
83 Eigen::AngleAxis<Precision> Z1_Angle(M_PI*roll/180.0,SimpleVector3::UnitZ());
84 Eigen::AngleAxis<Precision> X_Angle(M_PI*pitch/180.0,SimpleVector3::UnitX());
85 Eigen::AngleAxis<Precision> Z2_Angle(M_PI*yaw/180.0,SimpleVector3::UnitZ());
SimpleQuaternion euler2Quaternion(const Precision roll, const Precision pitch, const Precision yaw)
robot_model_services::MILDRobotStatePtr getRobotState(const geometry_msgs::Pose &initialPose)
void getRPY(tfScalar &roll, tfScalar &pitch, tfScalar &yaw, unsigned int solution_number=1) const
this namespace contains all generally usable classes.
SimpleQuaternion ZXZ2Quaternion(const Precision roll, const Precision pitch, const Precision yaw)
Eigen::Quaternion< Precision > SimpleQuaternion