Public Member Functions | |
void | callback1 (const sensor_msgs::JointStateConstPtr &msg) |
void | callback4 (const sensor_msgs::JointStateConstPtr &msg) |
void | callbackDiagnostic (const diagnostic_msgs::DiagnosticArrayConstPtr &msg) |
void | callbackJs (const sensor_msgs::JointStateConstPtr &msg) |
void | callbackMs (const pr2_mechanism_msgs::MechanismStatisticsConstPtr &msg) |
unsigned int | controllerState (const std::string &name) |
bool | loadController (const std::string &name) |
unsigned int | nrControllers () |
void | randomBombardment (unsigned int times) |
std::string | randomController () |
bool | switchController (const std::vector< std::string > &start, const std::vector< std::string > &stop, int strictness) |
bool | unloadController (const std::string &name) |
Public Attributes | |
unsigned int | callback1_counter_ |
double | callback1_effort_ |
std::string | callback1_name_ |
std::vector< ros::Time > | callback1_timing_ |
std::string | callback4_name_ |
unsigned int | callback_js_counter_ |
unsigned int | callback_ms_counter_ |
unsigned int | controller_diagnostic_counter_ |
unsigned int | joint_diagnostic_counter_ |
ros::ServiceClient | list_srv_ |
ros::ServiceClient | load_srv_ |
ros::NodeHandle | node_ |
ros::ServiceClient | switch_srv_ |
ros::ServiceClient | unload_srv_ |
Protected Member Functions | |
void | SetUp () |
void | TearDown () |
TestController () | |
constructor | |
~TestController () | |
Destructor. |
TestController::TestController | ( | ) | [inline, protected] |
TestController::~TestController | ( | ) | [inline, protected] |
void TestController::callback1 | ( | const sensor_msgs::JointStateConstPtr & | msg | ) | [inline] |
void TestController::callback4 | ( | const sensor_msgs::JointStateConstPtr & | msg | ) | [inline] |
void TestController::callbackDiagnostic | ( | const diagnostic_msgs::DiagnosticArrayConstPtr & | msg | ) | [inline] |
void TestController::callbackJs | ( | const sensor_msgs::JointStateConstPtr & | msg | ) | [inline] |
void TestController::callbackMs | ( | const pr2_mechanism_msgs::MechanismStatisticsConstPtr & | msg | ) | [inline] |
unsigned int TestController::controllerState | ( | const std::string & | name | ) | [inline] |
bool TestController::loadController | ( | const std::string & | name | ) | [inline] |
unsigned int TestController::nrControllers | ( | ) | [inline] |
void TestController::randomBombardment | ( | unsigned int | times | ) | [inline] |
std::string TestController::randomController | ( | ) | [inline] |
void TestController::SetUp | ( | ) | [inline, protected] |
bool TestController::switchController | ( | const std::vector< std::string > & | start, |
const std::vector< std::string > & | stop, | ||
int | strictness | ||
) | [inline] |
void TestController::TearDown | ( | ) | [inline, protected] |
bool TestController::unloadController | ( | const std::string & | name | ) | [inline] |
unsigned int TestController::callback1_counter_ |
std::string TestController::callback1_name_ |
std::string TestController::callback4_name_ |
unsigned int TestController::callback_js_counter_ |
unsigned int TestController::callback_ms_counter_ |
unsigned int TestController::controller_diagnostic_counter_ |
unsigned int TestController::joint_diagnostic_counter_ |