#include <BaseTest.h>

Public Member Functions | |
| BaseTest () | |
| BaseTest (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 silent) |
| void | initRosServices () |
| void | waitForEnter () |
| SimpleQuaternion | ZXZ2Quaternion (const Precision roll, const Precision pitch, const Precision yaw) |
| ~BaseTest () | |
Protected Attributes | |
| ros::Publisher | mInitPosePub |
| boost::shared_ptr < ros::NodeHandle > | mNodeHandle |
| bool | silent |
Definition at line 53 of file BaseTest.h.
Definition at line 25 of file BaseTest.cpp.
| BaseTest::BaseTest | ( | bool | silent | ) |
Definition at line 29 of file BaseTest.cpp.
Definition at line 33 of file BaseTest.cpp.
| SimpleQuaternion BaseTest::euler2Quaternion | ( | const Precision | roll, |
| const Precision | pitch, | ||
| const Precision | yaw | ||
| ) |
Definition at line 65 of file BaseTest.cpp.
| bool BaseTest::getParameter | ( | const std::string & | key, |
| T & | parameter | ||
| ) | [inline] |
Definition at line 78 of file BaseTest.h.
| robot_model_services::MILDRobotStatePtr BaseTest::getRobotState | ( | const geometry_msgs::Pose & | initialPose | ) |
Definition at line 44 of file BaseTest.cpp.
| void BaseTest::init | ( | bool | silent | ) |
Definition at line 35 of file BaseTest.cpp.
| void BaseTest::initRosServices | ( | ) |
| void BaseTest::waitForEnter | ( | ) |
Definition at line 55 of file BaseTest.cpp.
| SimpleQuaternion BaseTest::ZXZ2Quaternion | ( | const Precision | roll, |
| const Precision | pitch, | ||
| const Precision | yaw | ||
| ) |
Definition at line 78 of file BaseTest.cpp.
ros::Publisher BaseTest::mInitPosePub [protected] |
Definition at line 56 of file BaseTest.h.
boost::shared_ptr<ros::NodeHandle> BaseTest::mNodeHandle [protected] |
Definition at line 55 of file BaseTest.h.
bool BaseTest::silent [protected] |
Definition at line 57 of file BaseTest.h.