Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
JoystickInterruptTest Class Reference
Inheritance diagram for JoystickInterruptTest:
Inheritance graph
[legend]

Public Member Functions

 JoystickInterruptTest ()
 
void publishCmdVel (const float lin, const float ang)
 
void publishJoy (const int button, const int high_speed, const float lin0, const float ang0, const float lin1, const float ang1)
 

Protected Member Functions

void cbCmdVel (const geometry_msgs::Twist::ConstPtr &msg)
 

Protected Attributes

geometry_msgs::Twist::ConstPtr cmd_vel_
 
ros::NodeHandle nh_
 
ros::Publisher pub_cmd_vel_
 
ros::Publisher pub_joy_
 
ros::Subscriber sub_cmd_vel_
 

Detailed Description

Definition at line 37 of file test_joystick_interrupt.cpp.

Constructor & Destructor Documentation

JoystickInterruptTest::JoystickInterruptTest ( )
inline

Definition at line 53 of file test_joystick_interrupt.cpp.

Member Function Documentation

void JoystickInterruptTest::cbCmdVel ( const geometry_msgs::Twist::ConstPtr &  msg)
inlineprotected

Definition at line 47 of file test_joystick_interrupt.cpp.

void JoystickInterruptTest::publishCmdVel ( const float  lin,
const float  ang 
)
inline

Definition at line 69 of file test_joystick_interrupt.cpp.

void JoystickInterruptTest::publishJoy ( const int  button,
const int  high_speed,
const float  lin0,
const float  ang0,
const float  lin1,
const float  ang1 
)
inline

Definition at line 78 of file test_joystick_interrupt.cpp.

Member Data Documentation

geometry_msgs::Twist::ConstPtr JoystickInterruptTest::cmd_vel_
protected

Definition at line 45 of file test_joystick_interrupt.cpp.

ros::NodeHandle JoystickInterruptTest::nh_
protected

Definition at line 40 of file test_joystick_interrupt.cpp.

ros::Publisher JoystickInterruptTest::pub_cmd_vel_
protected

Definition at line 41 of file test_joystick_interrupt.cpp.

ros::Publisher JoystickInterruptTest::pub_joy_
protected

Definition at line 42 of file test_joystick_interrupt.cpp.

ros::Subscriber JoystickInterruptTest::sub_cmd_vel_
protected

Definition at line 43 of file test_joystick_interrupt.cpp.


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


joystick_interrupt
Author(s): Atsushi Watanabe
autogenerated on Wed May 12 2021 02:20:31