#include <pos_eff_controller.h>
Public Member Functions | |
bool | init (hardware_interface::RobotHW *robot_hw, ros::NodeHandle &n) |
PosEffController () | |
void | starting (const ros::Time &time) |
void | stopping (const ros::Time &time) |
void | update (const ros::Time &time, const ros::Duration &period) |
Private Attributes | |
std::vector < hardware_interface::JointHandle > | eff_cmd_ |
std::vector < hardware_interface::JointHandle > | pos_cmd_ |
Definition at line 38 of file pos_eff_controller.h.
Definition at line 43 of file pos_eff_controller.h.
bool PosEffController::init | ( | hardware_interface::RobotHW * | robot_hw, |
ros::NodeHandle & | n | ||
) | [virtual] |
Reimplemented from controller_interface::MultiInterfaceController< hardware_interface::PositionJointInterface, hardware_interface::EffortJointInterface >.
Definition at line 32 of file pos_eff_controller.cpp.
void PosEffController::starting | ( | const ros::Time & | time | ) | [virtual] |
Reimplemented from controller_interface::ControllerBase.
Definition at line 62 of file pos_eff_controller.cpp.
void PosEffController::stopping | ( | const ros::Time & | time | ) | [virtual] |
Reimplemented from controller_interface::ControllerBase.
Definition at line 70 of file pos_eff_controller.cpp.
void PosEffController::update | ( | const ros::Time & | time, |
const ros::Duration & | period | ||
) | [virtual] |
Implements controller_interface::ControllerBase.
Definition at line 67 of file pos_eff_controller.cpp.
std::vector<hardware_interface::JointHandle> controller_manager_tests::PosEffController::eff_cmd_ [private] |
Definition at line 52 of file pos_eff_controller.h.
std::vector<hardware_interface::JointHandle> controller_manager_tests::PosEffController::pos_cmd_ [private] |
Definition at line 51 of file pos_eff_controller.h.