Classes | Functions | Variables
test.cpp File Reference
#include <string>
#include <gtest/gtest.h>
#include <ros/ros.h>
#include <boost/thread.hpp>
#include <cstdlib>
#include <pr2_mechanism_msgs/LoadController.h>
#include <pr2_mechanism_msgs/UnloadController.h>
#include <pr2_mechanism_msgs/ListControllers.h>
#include <pr2_mechanism_msgs/SwitchController.h>
#include <sensor_msgs/JointState.h>
#include <pr2_mechanism_msgs/MechanismStatistics.h>
#include <diagnostic_msgs/DiagnosticArray.h>
Include dependency graph for test.cpp:

Go to the source code of this file.

Classes

class  TestController

Functions

int main (int argc, char **argv)
 TEST_F (TestController, spawner)
 TEST_F (TestController, loading)
 TEST_F (TestController, unloading)
 TEST_F (TestController, start_stop_strict)
 TEST_F (TestController, start_stop_best_effort)
 TEST_F (TestController, service_and_realtime_publisher)
 TEST_F (TestController, publisher_hz)
 TEST_F (TestController, manager_hz)
 TEST_F (TestController, diagnostic_hz)
 TEST_F (TestController, singlethread_bombardment)
 TEST_F (TestController, multithread_bombardment)

Variables

static const unsigned int _failure = 0
static const unsigned int _running = 3
static const unsigned int _stopped = 2
static const unsigned int _unloaded = 1
static bool bombardment_started_ = false
int g_argc
char ** g_argv

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 626 of file test.cpp.

TEST_F ( TestController  ,
spawner   
)

Definition at line 251 of file test.cpp.

TEST_F ( TestController  ,
loading   
)

Definition at line 274 of file test.cpp.

TEST_F ( TestController  ,
unloading   
)

Definition at line 327 of file test.cpp.

TEST_F ( TestController  ,
start_stop_strict   
)

Definition at line 368 of file test.cpp.

TEST_F ( TestController  ,
start_stop_best_effort   
)

Definition at line 441 of file test.cpp.

TEST_F ( TestController  ,
service_and_realtime_publisher   
)

Definition at line 473 of file test.cpp.

TEST_F ( TestController  ,
publisher_hz   
)

Definition at line 524 of file test.cpp.

TEST_F ( TestController  ,
manager_hz   
)

Definition at line 554 of file test.cpp.

TEST_F ( TestController  ,
diagnostic_hz   
)

Definition at line 585 of file test.cpp.

TEST_F ( TestController  ,
singlethread_bombardment   
)

Definition at line 602 of file test.cpp.

TEST_F ( TestController  ,
multithread_bombardment   
)

Definition at line 610 of file test.cpp.


Variable Documentation

const unsigned int _failure = 0 [static]

Definition at line 51 of file test.cpp.

const unsigned int _running = 3 [static]

Definition at line 54 of file test.cpp.

const unsigned int _stopped = 2 [static]

Definition at line 53 of file test.cpp.

const unsigned int _unloaded = 1 [static]

Definition at line 52 of file test.cpp.

bool bombardment_started_ = false [static]

Definition at line 60 of file test.cpp.

int g_argc

Definition at line 57 of file test.cpp.

char** g_argv

Definition at line 58 of file test.cpp.



pr2_controller_manager
Author(s): Eric Berger berger@willowgarage.com, Stuart Glaser, Wim Meeussen
autogenerated on Mon Dec 2 2013 13:13:13