#include <SerialCommandDevice.hpp>
Public Member Functions | |
SerialCommandDevice () | |
virtual | ~SerialCommandDevice () |
Private Member Functions | |
void | commandCallback (const telekyb_msgs::TKMotorCommands::ConstPtr &commandMsg) |
unsigned char | setpoint (double force) |
Private Attributes | |
ros::Subscriber | commandSub |
ros::NodeHandle | nodeHandle |
SerialCommandDeviceOptions & | options |
telekyb::Timer | secureTimer |
Definition at line 22 of file SerialCommandDevice.hpp.
Definition at line 12 of file SerialCommandDevice.cpp.
Definition at line 26 of file SerialCommandDevice.cpp.
void TELEKYB_NAMESPACE::SerialCommandDevice::commandCallback | ( | const telekyb_msgs::TKMotorCommands::ConstPtr & | commandMsg | ) | [private] |
Definition at line 30 of file SerialCommandDevice.cpp.
unsigned char TELEKYB_NAMESPACE::SerialCommandDevice::setpoint | ( | double | force | ) | [inline, private] |
Definition at line 57 of file SerialCommandDevice.cpp.
Definition at line 27 of file SerialCommandDevice.hpp.
Definition at line 26 of file SerialCommandDevice.hpp.
SerialCommandDeviceOptions& TELEKYB_NAMESPACE::SerialCommandDevice::options [private] |
Definition at line 24 of file SerialCommandDevice.hpp.
telekyb::Timer TELEKYB_NAMESPACE::SerialCommandDevice::secureTimer [private] |
Definition at line 28 of file SerialCommandDevice.hpp.