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 54 of file test_common.h.

Constructor & Destructor Documentation

◆ FourWheelSteeringControllerTest()

FourWheelSteeringControllerTest::FourWheelSteeringControllerTest ( )
inline

Definition at line 58 of file test_common.h.

◆ ~FourWheelSteeringControllerTest()

FourWheelSteeringControllerTest::~FourWheelSteeringControllerTest ( )
inline

Definition at line 68 of file test_common.h.

Member Function Documentation

◆ getLastOdom()

nav_msgs::Odometry FourWheelSteeringControllerTest::getLastOdom ( )
inline

Definition at line 73 of file test_common.h.

◆ hasReceivedFirstOdom()

bool FourWheelSteeringControllerTest::hasReceivedFirstOdom ( ) const
inline

Definition at line 85 of file test_common.h.

◆ isControllerAlive()

bool FourWheelSteeringControllerTest::isControllerAlive ( ) const
inline

Definition at line 82 of file test_common.h.

◆ odomCallback()

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

Definition at line 122 of file test_common.h.

◆ publish()

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

Definition at line 74 of file test_common.h.

◆ publish_4ws()

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

Definition at line 78 of file test_common.h.

◆ start()

void FourWheelSteeringControllerTest::start ( )
inline

Definition at line 87 of file test_common.h.

◆ stop()

void FourWheelSteeringControllerTest::stop ( )
inline

Definition at line 88 of file test_common.h.

◆ waitForController()

void FourWheelSteeringControllerTest::waitForController ( ) const
inline

Definition at line 90 of file test_common.h.

◆ waitForOdomMsgs()

void FourWheelSteeringControllerTest::waitForOdomMsgs ( ) const
inline

Definition at line 101 of file test_common.h.

Member Data Documentation

◆ cmd_4ws_pub

ros::Publisher FourWheelSteeringControllerTest::cmd_4ws_pub
private

Definition at line 115 of file test_common.h.

◆ cmd_twist_pub

ros::Publisher FourWheelSteeringControllerTest::cmd_twist_pub
private

Definition at line 115 of file test_common.h.

◆ last_odom

nav_msgs::Odometry FourWheelSteeringControllerTest::last_odom
private

Definition at line 117 of file test_common.h.

◆ nh

ros::NodeHandle FourWheelSteeringControllerTest::nh
private

Definition at line 114 of file test_common.h.

◆ odom_sub

ros::Subscriber FourWheelSteeringControllerTest::odom_sub
private

Definition at line 116 of file test_common.h.

◆ received_first_odom

bool FourWheelSteeringControllerTest::received_first_odom
private

Definition at line 113 of file test_common.h.

◆ start_srv

ros::ServiceClient FourWheelSteeringControllerTest::start_srv
private

Definition at line 119 of file test_common.h.

◆ stop_srv

ros::ServiceClient FourWheelSteeringControllerTest::stop_srv
private

Definition at line 120 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 Fri May 24 2024 02:41:15