#include <srh_syntouch_controllers.hpp>
Public Member Functions | |
bool | init (ros_ethercat_model::RobotState *robot, ros::NodeHandle &n) |
SrhSyntouchController () | |
virtual void | starting (const ros::Time &time) |
virtual void | update (const ros::Time &time, const ros::Duration &period) |
Issues commands to the joint. Should be called at regular intervals. | |
~SrhSyntouchController () | |
Private Attributes | |
sr_actuator::SrMotorActuator * | actuator_ |
boost::scoped_ptr < realtime_tools::RealtimePublisher < sr_robot_msgs::JointControllerState > > | controller_state_publisher_ |
Definition at line 37 of file srh_syntouch_controllers.hpp.
Definition at line 40 of file srh_syntouch_controllers.cpp.
Definition at line 45 of file srh_syntouch_controllers.cpp.
bool controller::SrhSyntouchController::init | ( | ros_ethercat_model::RobotState * | robot, |
ros::NodeHandle & | n | ||
) | [virtual] |
Implements controller::SrController.
Definition at line 50 of file srh_syntouch_controllers.cpp.
void controller::SrhSyntouchController::starting | ( | const ros::Time & | time | ) | [virtual] |
Reimplemented from controller::SrController.
Definition at line 85 of file srh_syntouch_controllers.cpp.
void controller::SrhSyntouchController::update | ( | const ros::Time & | time, |
const ros::Duration & | period | ||
) | [virtual] |
Issues commands to the joint. Should be called at regular intervals.
Implements controller::SrController.
Definition at line 92 of file srh_syntouch_controllers.cpp.
Definition at line 57 of file srh_syntouch_controllers.hpp.
boost::scoped_ptr<realtime_tools::RealtimePublisher<sr_robot_msgs::JointControllerState> > controller::SrhSyntouchController::controller_state_publisher_ [private] |
Reimplemented from controller::SrController.
Definition at line 55 of file srh_syntouch_controllers.hpp.