Keyboard remote control for your robot. More...
#include <keyop.hpp>
Public Member Functions | |
bool | init () |
Initialises the node. | |
KeyOp () | |
void | spin () |
Worker thread loop; sends current velocity command at a fixed rate. | |
~KeyOp () | |
Private Member Functions | |
void | decrementAngularVelocity () |
If not already mined, decrement the angular velocities.. | |
void | decrementLinearVelocity () |
If not already minned, decrement the linear velocities.. | |
void | disable () |
Disables commands to the navigation system. | |
void | enable () |
Reset/re-enable the navigation system. | |
void | incrementAngularVelocity () |
If not already maxxed, increment the angular velocities.. | |
void | incrementLinearVelocity () |
If not already maxxed, increment the command velocities.. | |
void | keyboardInputLoop () |
The worker thread function that accepts input keyboard commands. | |
void | processKeyboardInput (char c) |
Process individual keyboard inputs. | |
void | resetVelocity () |
void | restoreTerminal () |
Private Attributes | |
bool | accept_incoming_ |
double | angular_vel_max_ |
double | angular_vel_step_ |
geometry_msgs::TwistPtr | cmd_ |
geometry_msgs::TwistStampedPtr | cmd_stamped_ |
ros::Publisher | disable_motors_publisher_ |
ros::Publisher | enable_motors_publisher_ |
int | key_file_descriptor_ |
bool | last_zero_vel_sent_ |
double | linear_vel_max_ |
double | linear_vel_step_ |
std::string | name_ |
struct termios | original_terminal_state_ |
bool | power_status_ |
bool | quit_requested_ |
ecl::Thread | thread_ |
ros::Publisher | velocity_publisher_ |
bool | wait_for_connection_ |
void yocs_keyop::KeyOp::decrementAngularVelocity | ( | ) | [private] |
void yocs_keyop::KeyOp::decrementLinearVelocity | ( | ) | [private] |
void yocs_keyop::KeyOp::disable | ( | ) | [private] |
void yocs_keyop::KeyOp::enable | ( | ) | [private] |
void yocs_keyop::KeyOp::incrementAngularVelocity | ( | ) | [private] |
void yocs_keyop::KeyOp::incrementLinearVelocity | ( | ) | [private] |
bool yocs_keyop::KeyOp::init | ( | ) |
void yocs_keyop::KeyOp::keyboardInputLoop | ( | ) | [private] |
void yocs_keyop::KeyOp::processKeyboardInput | ( | char | c | ) | [private] |
void yocs_keyop::KeyOp::resetVelocity | ( | ) | [private] |
void yocs_keyop::KeyOp::restoreTerminal | ( | ) | [private] |
void yocs_keyop::KeyOp::spin | ( | ) |
bool yocs_keyop::KeyOp::accept_incoming_ [private] |
double yocs_keyop::KeyOp::angular_vel_max_ [private] |
double yocs_keyop::KeyOp::angular_vel_step_ [private] |
geometry_msgs::TwistPtr yocs_keyop::KeyOp::cmd_ [private] |
geometry_msgs::TwistStampedPtr yocs_keyop::KeyOp::cmd_stamped_ [private] |
int yocs_keyop::KeyOp::key_file_descriptor_ [private] |
bool yocs_keyop::KeyOp::last_zero_vel_sent_ [private] |
double yocs_keyop::KeyOp::linear_vel_max_ [private] |
double yocs_keyop::KeyOp::linear_vel_step_ [private] |
std::string yocs_keyop::KeyOp::name_ [private] |
struct termios yocs_keyop::KeyOp::original_terminal_state_ [private] |
bool yocs_keyop::KeyOp::power_status_ [private] |
bool yocs_keyop::KeyOp::quit_requested_ [private] |
ecl::Thread yocs_keyop::KeyOp::thread_ [private] |
bool yocs_keyop::KeyOp::wait_for_connection_ [private] |