Public Member Functions | Public Attributes | Protected Member Functions | List of all members
TestController Class Reference
Inheritance diagram for TestController:
Inheritance graph
[legend]

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::Timecallback1_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 More...
 
 ~TestController ()
 Destructor. More...
 

Detailed Description

Definition at line 63 of file test.cpp.

Constructor & Destructor Documentation

TestController::TestController ( )
inlineprotected

constructor

Definition at line 217 of file test.cpp.

TestController::~TestController ( )
inlineprotected

Destructor.

Definition at line 223 of file test.cpp.

Member Function Documentation

void TestController::callback1 ( const sensor_msgs::JointStateConstPtr &  msg)
inline

Definition at line 99 of file test.cpp.

void TestController::callback4 ( const sensor_msgs::JointStateConstPtr &  msg)
inline

Definition at line 109 of file test.cpp.

void TestController::callbackDiagnostic ( const diagnostic_msgs::DiagnosticArrayConstPtr &  msg)
inline

Definition at line 74 of file test.cpp.

void TestController::callbackJs ( const sensor_msgs::JointStateConstPtr &  msg)
inline

Definition at line 88 of file test.cpp.

void TestController::callbackMs ( const pr2_mechanism_msgs::MechanismStatisticsConstPtr &  msg)
inline

Definition at line 94 of file test.cpp.

unsigned int TestController::controllerState ( const std::string &  name)
inline

Definition at line 151 of file test.cpp.

bool TestController::loadController ( const std::string &  name)
inline

Definition at line 114 of file test.cpp.

unsigned int TestController::nrControllers ( )
inline

Definition at line 143 of file test.cpp.

void TestController::randomBombardment ( unsigned int  times)
inline

Definition at line 175 of file test.cpp.

std::string TestController::randomController ( )
inline

Definition at line 166 of file test.cpp.

void TestController::SetUp ( )
inlineprotected

Definition at line 227 of file test.cpp.

bool TestController::switchController ( const std::vector< std::string > &  start,
const std::vector< std::string > &  stop,
int  strictness 
)
inline

Definition at line 132 of file test.cpp.

void TestController::TearDown ( )
inlineprotected

Definition at line 241 of file test.cpp.

bool TestController::unloadController ( const std::string &  name)
inline

Definition at line 123 of file test.cpp.

Member Data Documentation

unsigned int TestController::callback1_counter_

Definition at line 69 of file test.cpp.

double TestController::callback1_effort_

Definition at line 72 of file test.cpp.

std::string TestController::callback1_name_

Definition at line 68 of file test.cpp.

std::vector<ros::Time> TestController::callback1_timing_

Definition at line 70 of file test.cpp.

std::string TestController::callback4_name_

Definition at line 68 of file test.cpp.

unsigned int TestController::callback_js_counter_

Definition at line 69 of file test.cpp.

unsigned int TestController::callback_ms_counter_

Definition at line 69 of file test.cpp.

unsigned int TestController::controller_diagnostic_counter_

Definition at line 71 of file test.cpp.

unsigned int TestController::joint_diagnostic_counter_

Definition at line 71 of file test.cpp.

ros::ServiceClient TestController::list_srv_

Definition at line 67 of file test.cpp.

ros::ServiceClient TestController::load_srv_

Definition at line 67 of file test.cpp.

ros::NodeHandle TestController::node_

Definition at line 66 of file test.cpp.

ros::ServiceClient TestController::switch_srv_

Definition at line 67 of file test.cpp.

ros::ServiceClient TestController::unload_srv_

Definition at line 67 of file test.cpp.


The documentation for this class was generated from the following file:


pr2_controller_manager
Author(s): Eric Berger berger@willowgarage.com, Stuart Glaser, Wim Meeussen
autogenerated on Fri Jun 7 2019 22:04:28