#include <test_common.h>
| Public Member Functions | |
| nav_msgs::Odometry | getLastOdom () | 
| bool | isControllerAlive () | 
| void | publish (geometry_msgs::Twist cmd_vel) | 
| void | start () | 
| SteerDriveControllerTest () | |
| void | stop () | 
| ~SteerDriveControllerTest () | |
| Private Member Functions | |
| void | odomCallback (const nav_msgs::Odometry &odom) | 
| Private Attributes | |
| ros::Publisher | cmd_pub | 
| nav_msgs::Odometry | last_odom | 
| ros::NodeHandle | nh | 
| ros::Subscriber | odom_sub | 
| ros::ServiceClient | start_srv | 
| ros::ServiceClient | stop_srv | 
Definition at line 52 of file test_common.h.
| SteerDriveControllerTest::SteerDriveControllerTest | ( | ) |  [inline] | 
Definition at line 56 of file test_common.h.
| SteerDriveControllerTest::~SteerDriveControllerTest | ( | ) |  [inline] | 
Definition at line 64 of file test_common.h.
| nav_msgs::Odometry SteerDriveControllerTest::getLastOdom | ( | ) |  [inline] | 
Definition at line 69 of file test_common.h.
| bool SteerDriveControllerTest::isControllerAlive | ( | ) |  [inline] | 
Definition at line 71 of file test_common.h.
| void SteerDriveControllerTest::odomCallback | ( | const nav_msgs::Odometry & | odom | ) |  [inline, private] | 
Definition at line 85 of file test_common.h.
| void SteerDriveControllerTest::publish | ( | geometry_msgs::Twist | cmd_vel | ) |  [inline] | 
Definition at line 70 of file test_common.h.
| void SteerDriveControllerTest::start | ( | ) |  [inline] | 
Definition at line 73 of file test_common.h.
| void SteerDriveControllerTest::stop | ( | ) |  [inline] | 
Definition at line 74 of file test_common.h.
Definition at line 78 of file test_common.h.
| nav_msgs::Odometry SteerDriveControllerTest::last_odom  [private] | 
Definition at line 80 of file test_common.h.
| ros::NodeHandle SteerDriveControllerTest::nh  [private] | 
Definition at line 77 of file test_common.h.
Definition at line 79 of file test_common.h.
Definition at line 82 of file test_common.h.
Definition at line 83 of file test_common.h.