6 #ifndef YOCS_KEYOP_KEYOP_HPP_ 7 #define YOCS_KEYOP_KEYOP_HPP_ 12 #include <geometry_msgs/Twist.h> 13 #include <geometry_msgs/TwistStamped.h> 43 geometry_msgs::TwistPtr
cmd_;
ros::Publisher disable_motors_publisher_
ros::Publisher velocity_publisher_
void keyboardInputLoop()
The worker thread function that accepts input keyboard commands.
void enable()
Reset/re-enable the navigation system.
ros::Publisher enable_motors_publisher_
void decrementLinearVelocity()
If not already minned, decrement the linear velocities..
void spin()
Worker thread loop; sends current velocity command at a fixed rate.
void incrementAngularVelocity()
If not already maxxed, increment the angular velocities..
void processKeyboardInput(char c)
Process individual keyboard inputs.
Keyboard remote control for your robot.
geometry_msgs::TwistStampedPtr cmd_stamped_
void incrementLinearVelocity()
If not already maxxed, increment the command velocities..
struct termios original_terminal_state_
bool wait_for_connection_
geometry_msgs::TwistPtr cmd_
bool init()
Initialises the node.
void disable()
Disables commands to the navigation system.
void decrementAngularVelocity()
If not already mined, decrement the angular velocities..