|
| DifferentialCalibrationController ()=default |
|
bool | init (hardware_interface::RobotHW *robot_hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh) override |
|
void | update (const ros::Time &time, const ros::Duration &period) override |
|
| CalibrationBase ()=default |
|
bool | init (hardware_interface::RobotHW *robot_hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh) override |
| Get necessary params from param server. Init joint_calibration_controller. More...
|
|
void | starting (const ros::Time &time) override |
| Switch all of the actuators state to INITIALIZED. More...
|
|
void | stopping (const ros::Time &time) override |
|
virtual bool | init (hardware_interface::RobotHW *, ros::NodeHandle &) |
|
| MultiInterfaceController (bool allow_optional_interfaces=false) |
|
virtual void | aborting (const ros::Time &) |
|
virtual void | aborting (const ros::Time &) |
|
bool | abortRequest (const ros::Time &time) |
|
bool | abortRequest (const ros::Time &time) |
|
| ControllerBase ()=default |
|
| ControllerBase (const ControllerBase &)=delete |
|
| ControllerBase (ControllerBase &&)=delete |
|
bool | isAborted () const |
|
bool | isAborted () const |
|
bool | isInitialized () const |
|
bool | isInitialized () const |
|
bool | isRunning () const |
|
bool | isRunning () const |
|
bool | isStopped () const |
|
bool | isStopped () const |
|
bool | isWaiting () const |
|
bool | isWaiting () const |
|
ControllerBase & | operator= (const ControllerBase &)=delete |
|
ControllerBase & | operator= (ControllerBase &&)=delete |
|
bool | startRequest (const ros::Time &time) |
|
bool | startRequest (const ros::Time &time) |
|
bool | stopRequest (const ros::Time &time) |
|
bool | stopRequest (const ros::Time &time) |
|
void | updateRequest (const ros::Time &time, const ros::Duration &period) |
|
void | updateRequest (const ros::Time &time, const ros::Duration &period) |
|
virtual void | waiting (const ros::Time &) |
|
virtual void | waiting (const ros::Time &) |
|
bool | waitRequest (const ros::Time &time) |
|
bool | waitRequest (const ros::Time &time) |
|
virtual | ~ControllerBase ()=default |
|