|
| void | configurablePointCloudsTest () |
| |
| asr_msgs::AsrAttributedPoint | getAttributedPoint (SimpleVector3 position, SimpleVector3 positionDeviation, SimpleQuaternion orientation, float orientationDeviation, std::vector< std::string > objectTypeNames, std::map< std::string, std::vector< double >> typeToOrientation, int iteration) |
| |
| SimpleQuaternion | getOrientation (SimpleQuaternion originalOrientation, double alpha, double beta, double gamma) |
| |
| template<typename T > |
| bool | getParameter (const std::string &key, T ¶meter) |
| |
| | ParametersTest () |
| |
| void | positionsTest () |
| |
| void | sideObjectTest () |
| |
| virtual | ~ParametersTest () |
| |
| | 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 () |
| |
The ParametersTest class is a test class to check the NBV parameters. It works with the map "map_flur".
Definition at line 40 of file ParametersTest.cpp.