
Public Member Functions | |
| void | evaluateS2CandC2S () |
| evaluates the correctness of the Sphere To Cartesian and Cartesian To Sphere Methods. More... | |
| void | iterationTest () |
| MathTest () | |
| virtual | ~MathTest () |
Public Member Functions inherited from BaseTest | |
| BaseTest () | |
| BaseTest (bool useRos, bool silent) | |
| SimpleQuaternion | euler2Quaternion (const Precision roll, const Precision pitch, const Precision yaw) |
| template<typename T > | |
| bool | getParameter (const std::string &key, T ¶meter) |
| robot_model_services::MILDRobotStatePtr | getRobotState (const geometry_msgs::Pose &initialPose) |
| void | init (bool useRos, bool silent) |
| void | initRosServices () |
| void | setInitialPose (const geometry_msgs::Pose &initialPose, boost::shared_ptr< NextBestView > nbv=nullptr) |
| void | setInitialRobotState (const geometry_msgs::Pose &initialPose, boost::shared_ptr< NextBestView > nbv=nullptr) |
| void | waitForEnter () |
| SimpleQuaternion | ZXZ2Quaternion (const Precision roll, const Precision pitch, const Precision yaw) |
| ~BaseTest () | |
Definition at line 28 of file MathTest.cpp.
|
inline |
Definition at line 30 of file MathTest.cpp.
|
inlinevirtual |
Definition at line 32 of file MathTest.cpp.
|
inline |
evaluates the correctness of the Sphere To Cartesian and Cartesian To Sphere Methods.
Definition at line 37 of file MathTest.cpp.
|
inline |
Definition at line 69 of file MathTest.cpp.