|
| void | iterationTest () |
| |
| | StreamTest () |
| |
| void | testString (std::string stringToTest, std::vector< std::string > occurrencesInString) |
| |
| virtual | ~StreamTest () |
| |
| | 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 32 of file StreamTest.cpp.