Public Member Functions | |
void | Initialize () |
RmpTeleop () | |
~RmpTeleop () | |
Private Member Functions | |
void | ProcessJoystickMessage (const sensor_msgs::Joy::ConstPtr &rpJoyMessage) |
Private Attributes | |
ros::Publisher | m_AudioCommandPublisher |
ros::Publisher | m_DeadmanPublisher |
ros::Subscriber | m_JoystickMessageSubscriber |
ros::NodeHandle | m_NodeHandle |
JoystickConverter::Ptr | m_pJoystickConverter |
double | m_RotationalVelocityBoostScale |
double | m_RotationalVelocityScale |
double | m_TranslationalVelocityBoostScale |
double | m_TranslationalVelocityScale |
ros::Publisher | m_VelocityCommandPublisher |
This class is used to convert joystick input to rmp control commands.
Definition at line 50 of file rmp_teleop_node.cpp.
Constructor
Definition at line 132 of file rmp_teleop_node.cpp.
Destructor
Definition at line 140 of file rmp_teleop_node.cpp.
void RmpTeleop::Initialize | ( | ) |
Initialize the communication
Definition at line 143 of file rmp_teleop_node.cpp.
void RmpTeleop::ProcessJoystickMessage | ( | const sensor_msgs::Joy::ConstPtr & | rpJoyMessage | ) | [private] |
Process joystick messages
Definition at line 177 of file rmp_teleop_node.cpp.
Audio command publisher
Definition at line 92 of file rmp_teleop_node.cpp.
ros::Publisher RmpTeleop::m_DeadmanPublisher [private] |
Deadman message publisher
Definition at line 87 of file rmp_teleop_node.cpp.
Joystick message subscriber
Definition at line 97 of file rmp_teleop_node.cpp.
ros::NodeHandle RmpTeleop::m_NodeHandle [private] |
Ros interface
Definition at line 77 of file rmp_teleop_node.cpp.
Joystick converter Convert joystick messages to rmp commands.
Definition at line 103 of file rmp_teleop_node.cpp.
double RmpTeleop::m_RotationalVelocityBoostScale [private] |
Rotational velocity scale Scale joystick input to rotational velocity command when the boost is active
Definition at line 129 of file rmp_teleop_node.cpp.
double RmpTeleop::m_RotationalVelocityScale [private] |
Rotational velocity scale Scale joystick input to rotational velocity command
Definition at line 115 of file rmp_teleop_node.cpp.
double RmpTeleop::m_TranslationalVelocityBoostScale [private] |
Translational velocity scale Scale joystick input to translational velocity command when the boost is active
Definition at line 122 of file rmp_teleop_node.cpp.
double RmpTeleop::m_TranslationalVelocityScale [private] |
Translational velocity scale Scale joystick input to translational velocity command
Definition at line 109 of file rmp_teleop_node.cpp.
Velocity command publisher
Definition at line 82 of file rmp_teleop_node.cpp.