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 ()
 
control_msgs::JointTrajectoryControllerState getLastJointTrajectoryControllerState ()
 
nav_msgs::Odometry getLastOdom ()
 
bool hasReceivedFirstOdom () const
 
bool isControllerAlive () const
 
bool isPublishingCmdVelOut (const ros::Duration &timeout=ros::Duration(1)) const
 
bool isPublishingJointTrajectoryControllerState ()
 
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 jointTrajectoryControllerStateCallback (const control_msgs::JointTrajectoryControllerState &joint_traj_controller_state)
 
void odomCallback (const nav_msgs::Odometry &odom)
 

Private Attributes

ros::Publisher cmd_pub
 
ros::Subscriber joint_traj_controller_state_sub
 
geometry_msgs::TwistStamped last_cmd_vel_out
 
control_msgs::JointTrajectoryControllerState last_joint_traj_controller_state
 
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 54 of file test_common.h.

Constructor & Destructor Documentation

◆ DiffDriveControllerTest()

DiffDriveControllerTest::DiffDriveControllerTest ( )
inline

Definition at line 58 of file test_common.h.

◆ ~DiffDriveControllerTest()

DiffDriveControllerTest::~DiffDriveControllerTest ( )
inline

Definition at line 69 of file test_common.h.

Member Function Documentation

◆ cmdVelOutCallback()

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

Definition at line 151 of file test_common.h.

◆ getLastCmdVelOut()

geometry_msgs::TwistStamped DiffDriveControllerTest::getLastCmdVelOut ( )
inline

Definition at line 76 of file test_common.h.

◆ getLastJointTrajectoryControllerState()

control_msgs::JointTrajectoryControllerState DiffDriveControllerTest::getLastJointTrajectoryControllerState ( )
inline

Definition at line 77 of file test_common.h.

◆ getLastOdom()

nav_msgs::Odometry DiffDriveControllerTest::getLastOdom ( )
inline

Definition at line 75 of file test_common.h.

◆ hasReceivedFirstOdom()

bool DiffDriveControllerTest::hasReceivedFirstOdom ( ) const
inline

Definition at line 91 of file test_common.h.

◆ isControllerAlive()

bool DiffDriveControllerTest::isControllerAlive ( ) const
inline

Definition at line 79 of file test_common.h.

◆ isPublishingCmdVelOut()

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

Definition at line 80 of file test_common.h.

◆ isPublishingJointTrajectoryControllerState()

bool DiffDriveControllerTest::isPublishingJointTrajectoryControllerState ( )
inline

Definition at line 90 of file test_common.h.

◆ jointTrajectoryControllerStateCallback()

void DiffDriveControllerTest::jointTrajectoryControllerStateCallback ( const control_msgs::JointTrajectoryControllerState &  joint_traj_controller_state)
inlineprivate

Definition at line 142 of file test_common.h.

◆ odomCallback()

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

Definition at line 132 of file test_common.h.

◆ publish()

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

Definition at line 78 of file test_common.h.

◆ start()

void DiffDriveControllerTest::start ( )
inline

Definition at line 93 of file test_common.h.

◆ stop()

void DiffDriveControllerTest::stop ( )
inline

Definition at line 94 of file test_common.h.

◆ waitForController()

void DiffDriveControllerTest::waitForController ( ) const
inline

Definition at line 96 of file test_common.h.

◆ waitForOdomMsgs()

void DiffDriveControllerTest::waitForOdomMsgs ( ) const
inline

Definition at line 107 of file test_common.h.

Member Data Documentation

◆ cmd_pub

ros::Publisher DiffDriveControllerTest::cmd_pub
private

Definition at line 121 of file test_common.h.

◆ joint_traj_controller_state_sub

ros::Subscriber DiffDriveControllerTest::joint_traj_controller_state_sub
private

Definition at line 126 of file test_common.h.

◆ last_cmd_vel_out

geometry_msgs::TwistStamped DiffDriveControllerTest::last_cmd_vel_out
private

Definition at line 125 of file test_common.h.

◆ last_joint_traj_controller_state

control_msgs::JointTrajectoryControllerState DiffDriveControllerTest::last_joint_traj_controller_state
private

Definition at line 127 of file test_common.h.

◆ last_odom

nav_msgs::Odometry DiffDriveControllerTest::last_odom
private

Definition at line 124 of file test_common.h.

◆ nh

ros::NodeHandle DiffDriveControllerTest::nh
private

Definition at line 120 of file test_common.h.

◆ odom_sub

ros::Subscriber DiffDriveControllerTest::odom_sub
private

Definition at line 122 of file test_common.h.

◆ received_first_odom

bool DiffDriveControllerTest::received_first_odom
private

Definition at line 119 of file test_common.h.

◆ start_srv

ros::ServiceClient DiffDriveControllerTest::start_srv
private

Definition at line 129 of file test_common.h.

◆ stop_srv

ros::ServiceClient DiffDriveControllerTest::stop_srv
private

Definition at line 130 of file test_common.h.

◆ vel_out_sub

ros::Subscriber DiffDriveControllerTest::vel_out_sub
private

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