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

#include <test_common.h>

Inheritance diagram for DiffDriveControllerTest:
Inheritance graph
[legend]

Public Member Functions

 DiffDriveControllerTest ()
 
geometry_msgs::TwistStamped getLastCmdVelOut ()
 
nav_msgs::Odometry getLastOdom ()
 
bool hasReceivedFirstOdom () const
 
bool isControllerAlive () const
 
bool isPublishingCmdVelOut (const ros::Duration &timeout=ros::Duration(1)) const
 
void publish (geometry_msgs::Twist cmd_vel)
 
void start ()
 
void stop ()
 
void waitForController () const
 
void waitForOdomMsgs () const
 
 ~DiffDriveControllerTest ()
 

Private Member Functions

void cmdVelOutCallback (const geometry_msgs::TwistStamped &cmd_vel_out)
 
void odomCallback (const nav_msgs::Odometry &odom)
 

Private Attributes

ros::Publisher cmd_pub
 
geometry_msgs::TwistStamped last_cmd_vel_out
 
nav_msgs::Odometry last_odom
 
ros::NodeHandle nh
 
ros::Subscriber odom_sub
 
bool received_first_odom
 
ros::ServiceClient start_srv
 
ros::ServiceClient stop_srv
 
ros::Subscriber vel_out_sub
 

Detailed Description

Definition at line 50 of file test_common.h.

Constructor & Destructor Documentation

DiffDriveControllerTest::DiffDriveControllerTest ( )
inline

Definition at line 54 of file test_common.h.

DiffDriveControllerTest::~DiffDriveControllerTest ( )
inline

Definition at line 64 of file test_common.h.

Member Function Documentation

void DiffDriveControllerTest::cmdVelOutCallback ( const geometry_msgs::TwistStamped &  cmd_vel_out)
inlineprivate

Definition at line 132 of file test_common.h.

geometry_msgs::TwistStamped DiffDriveControllerTest::getLastCmdVelOut ( )
inline

Definition at line 70 of file test_common.h.

nav_msgs::Odometry DiffDriveControllerTest::getLastOdom ( )
inline

Definition at line 69 of file test_common.h.

bool DiffDriveControllerTest::hasReceivedFirstOdom ( ) const
inline

Definition at line 83 of file test_common.h.

bool DiffDriveControllerTest::isControllerAlive ( ) const
inline

Definition at line 72 of file test_common.h.

bool DiffDriveControllerTest::isPublishingCmdVelOut ( const ros::Duration timeout = ros::Duration(1)) const
inline

Definition at line 73 of file test_common.h.

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

Definition at line 122 of file test_common.h.

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

Definition at line 71 of file test_common.h.

void DiffDriveControllerTest::start ( )
inline

Definition at line 85 of file test_common.h.

void DiffDriveControllerTest::stop ( )
inline

Definition at line 86 of file test_common.h.

void DiffDriveControllerTest::waitForController ( ) const
inline

Definition at line 88 of file test_common.h.

void DiffDriveControllerTest::waitForOdomMsgs ( ) const
inline

Definition at line 99 of file test_common.h.

Member Data Documentation

ros::Publisher DiffDriveControllerTest::cmd_pub
private

Definition at line 113 of file test_common.h.

geometry_msgs::TwistStamped DiffDriveControllerTest::last_cmd_vel_out
private

Definition at line 117 of file test_common.h.

nav_msgs::Odometry DiffDriveControllerTest::last_odom
private

Definition at line 116 of file test_common.h.

ros::NodeHandle DiffDriveControllerTest::nh
private

Definition at line 112 of file test_common.h.

ros::Subscriber DiffDriveControllerTest::odom_sub
private

Definition at line 114 of file test_common.h.

bool DiffDriveControllerTest::received_first_odom
private

Definition at line 111 of file test_common.h.

ros::ServiceClient DiffDriveControllerTest::start_srv
private

Definition at line 119 of file test_common.h.

ros::ServiceClient DiffDriveControllerTest::stop_srv
private

Definition at line 120 of file test_common.h.

ros::Subscriber DiffDriveControllerTest::vel_out_sub
private

Definition at line 115 of file test_common.h.


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


diff_drive_controller
Author(s): Bence Magyar
autogenerated on Thu Apr 11 2019 03:08:07