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 (const std::string &cmd_vel_topic="cmd_vel")
 
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 39 of file test_joystick_interrupt.cpp.

Constructor & Destructor Documentation

◆ JoystickInterruptTest()

JoystickInterruptTest::JoystickInterruptTest ( const std::string &  cmd_vel_topic = "cmd_vel")
inlineexplicit

Definition at line 55 of file test_joystick_interrupt.cpp.

Member Function Documentation

◆ cbCmdVel()

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

Definition at line 49 of file test_joystick_interrupt.cpp.

◆ publishCmdVel()

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

Definition at line 71 of file test_joystick_interrupt.cpp.

◆ publishJoy()

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 80 of file test_joystick_interrupt.cpp.

Member Data Documentation

◆ cmd_vel_

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

Definition at line 47 of file test_joystick_interrupt.cpp.

◆ nh_

ros::NodeHandle JoystickInterruptTest::nh_
protected

Definition at line 42 of file test_joystick_interrupt.cpp.

◆ pub_cmd_vel_

ros::Publisher JoystickInterruptTest::pub_cmd_vel_
protected

Definition at line 43 of file test_joystick_interrupt.cpp.

◆ pub_joy_

ros::Publisher JoystickInterruptTest::pub_joy_
protected

Definition at line 44 of file test_joystick_interrupt.cpp.

◆ sub_cmd_vel_

ros::Subscriber JoystickInterruptTest::sub_cmd_vel_
protected

Definition at line 45 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 Mon Jul 3 2023 02:38:51