
Public Member Functions | |
| ros::Duration | getPeriod () const |
| ros::Time | getTime () const |
| void | read () |
| RRbot () | |
| void | write () |
Private Member Functions | |
| void | smoothingCB (const std_msgs::Float64 &smoothing) |
Private Attributes | |
| double | cmd_ [2] |
| double | eff_ [2] |
| hardware_interface::PositionJointInterface | jnt_pos_interface_ |
| hardware_interface::JointStateInterface | jnt_state_interface_ |
| double | pos_ [2] |
| realtime_tools::RealtimeBuffer < double > | smoothing_ |
| ros::Subscriber | smoothing_sub_ |
| double | vel_ [2] |
| RRbot::RRbot | ( | ) | [inline] |
| ros::Duration RRbot::getPeriod | ( | ) | const [inline] |
| ros::Time RRbot::getTime | ( | ) | const [inline] |
| void RRbot::read | ( | ) | [inline] |
| void RRbot::smoothingCB | ( | const std_msgs::Float64 & | smoothing | ) | [inline, private] |
| void RRbot::write | ( | ) | [inline] |
double RRbot::cmd_[2] [private] |
double RRbot::eff_[2] [private] |
double RRbot::pos_[2] [private] |
realtime_tools::RealtimeBuffer<double> RRbot::smoothing_ [private] |
ros::Subscriber RRbot::smoothing_sub_ [private] |
double RRbot::vel_[2] [private] |