Public Member Functions | Private Member Functions | Private Attributes | List of all members
FourWheelSteeringControllerTest Class Reference

#include <test_common.h>

Inheritance diagram for FourWheelSteeringControllerTest:
Inheritance graph
[legend]

Public Member Functions

 FourWheelSteeringControllerTest ()
 
nav_msgs::Odometry getLastOdom ()
 
bool hasReceivedFirstOdom () const
 
bool isControllerAlive () const
 
void publish (geometry_msgs::Twist cmd_vel)
 
void publish_4ws (four_wheel_steering_msgs::FourWheelSteering cmd_vel)
 
void start ()
 
void stop ()
 
void waitForController () const
 
void waitForOdomMsgs () const
 
 ~FourWheelSteeringControllerTest ()
 

Private Member Functions

void odomCallback (const nav_msgs::Odometry &odom)
 

Private Attributes

ros::Publisher cmd_4ws_pub
 
ros::Publisher cmd_twist_pub
 
nav_msgs::Odometry last_odom
 
ros::NodeHandle nh
 
ros::Subscriber odom_sub
 
bool received_first_odom
 
ros::ServiceClient start_srv
 
ros::ServiceClient stop_srv
 

Detailed Description

Definition at line 51 of file test_common.h.

Constructor & Destructor Documentation

FourWheelSteeringControllerTest::FourWheelSteeringControllerTest ( )
inline

Definition at line 55 of file test_common.h.

FourWheelSteeringControllerTest::~FourWheelSteeringControllerTest ( )
inline

Definition at line 65 of file test_common.h.

Member Function Documentation

nav_msgs::Odometry FourWheelSteeringControllerTest::getLastOdom ( )
inline

Definition at line 70 of file test_common.h.

bool FourWheelSteeringControllerTest::hasReceivedFirstOdom ( ) const
inline

Definition at line 82 of file test_common.h.

bool FourWheelSteeringControllerTest::isControllerAlive ( ) const
inline

Definition at line 79 of file test_common.h.

void FourWheelSteeringControllerTest::odomCallback ( const nav_msgs::Odometry &  odom)
inlineprivate

Definition at line 119 of file test_common.h.

void FourWheelSteeringControllerTest::publish ( geometry_msgs::Twist  cmd_vel)
inline

Definition at line 71 of file test_common.h.

void FourWheelSteeringControllerTest::publish_4ws ( four_wheel_steering_msgs::FourWheelSteering  cmd_vel)
inline

Definition at line 75 of file test_common.h.

void FourWheelSteeringControllerTest::start ( )
inline

Definition at line 84 of file test_common.h.

void FourWheelSteeringControllerTest::stop ( )
inline

Definition at line 85 of file test_common.h.

void FourWheelSteeringControllerTest::waitForController ( ) const
inline

Definition at line 87 of file test_common.h.

void FourWheelSteeringControllerTest::waitForOdomMsgs ( ) const
inline

Definition at line 98 of file test_common.h.

Member Data Documentation

ros::Publisher FourWheelSteeringControllerTest::cmd_4ws_pub
private

Definition at line 112 of file test_common.h.

ros::Publisher FourWheelSteeringControllerTest::cmd_twist_pub
private

Definition at line 112 of file test_common.h.

nav_msgs::Odometry FourWheelSteeringControllerTest::last_odom
private

Definition at line 114 of file test_common.h.

ros::NodeHandle FourWheelSteeringControllerTest::nh
private

Definition at line 111 of file test_common.h.

ros::Subscriber FourWheelSteeringControllerTest::odom_sub
private

Definition at line 113 of file test_common.h.

bool FourWheelSteeringControllerTest::received_first_odom
private

Definition at line 110 of file test_common.h.

ros::ServiceClient FourWheelSteeringControllerTest::start_srv
private

Definition at line 116 of file test_common.h.

ros::ServiceClient FourWheelSteeringControllerTest::stop_srv
private

Definition at line 117 of file test_common.h.


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


four_wheel_steering_controller
Author(s): Vincent Rousseau
autogenerated on Thu Apr 11 2019 03:08:25