#include <effort_test_controller.h>
Public Member Functions | |
EffortTestController () | |
bool | init (hardware_interface::EffortJointInterface *hw, ros::NodeHandle &) |
void | starting (const ros::Time &) |
void | stopping (const ros::Time &) |
void | update (const ros::Time &, const ros::Duration &) |
Private Attributes | |
std::vector < hardware_interface::JointHandle > | joint_effort_commands_ |
Definition at line 41 of file effort_test_controller.h.
Definition at line 44 of file effort_test_controller.h.
bool EffortTestController::init | ( | hardware_interface::EffortJointInterface * | hw, |
ros::NodeHandle & | n | ||
) | [virtual] |
Reimplemented from controller_interface::Controller< hardware_interface::EffortJointInterface >.
Definition at line 33 of file effort_test_controller.cpp.
void EffortTestController::starting | ( | const ros::Time & | ) | [virtual] |
Reimplemented from controller_interface::ControllerBase.
Definition at line 53 of file effort_test_controller.cpp.
void EffortTestController::stopping | ( | const ros::Time & | ) | [virtual] |
Reimplemented from controller_interface::ControllerBase.
Definition at line 66 of file effort_test_controller.cpp.
void EffortTestController::update | ( | const ros::Time & | , |
const ros::Duration & | |||
) | [virtual] |
Implements controller_interface::ControllerBase.
Definition at line 58 of file effort_test_controller.cpp.
std::vector<hardware_interface::JointHandle> controller_manager_tests::EffortTestController::joint_effort_commands_ [private] |
Definition at line 53 of file effort_test_controller.h.