Public Member Functions | List of all members
controller_manager_tests::DerivedController Class Reference

#include <extensible_controllers.h>

Inheritance diagram for controller_manager_tests::DerivedController:
Inheritance graph
[legend]

Public Member Functions

int helper () override
 
bool init (hardware_interface::RobotHW *robot_hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh) override
 
bool initRequest (hardware_interface::RobotHW *hw, ros::NodeHandle &nh, ros::NodeHandle &pnh, controller_interface::ControllerBase::ClaimedResources &cr) override
 
- Public Member Functions inherited from controller_manager_tests::ExtensibleController
void update (const ros::Time &, const ros::Duration &) override
 
- Public Member Functions inherited from controller_interface::MultiInterfaceController< T >
virtual bool init (hardware_interface::RobotHW *, ros::NodeHandle &)
 
 MultiInterfaceController (bool allow_optional_interfaces=false)
 
- Public Member Functions inherited from controller_interface::ControllerBase
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
 
ControllerBaseoperator= (const ControllerBase &)=delete
 
ControllerBaseoperator= (ControllerBase &&)=delete
 
virtual void starting (const ros::Time &)
 
virtual void starting (const ros::Time &)
 
bool startRequest (const ros::Time &time)
 
bool startRequest (const ros::Time &time)
 
virtual void stopping (const ros::Time &)
 
virtual void stopping (const ros::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
 
- Public Member Functions inherited from controller_interface::MultiInterfaceController< hardware_interface::VelocityJointInterface, hardware_interface::EffortJointInterface >
virtual bool init (hardware_interface::RobotHW *, ros::NodeHandle &)
 
 MultiInterfaceController (bool allow_optional_interfaces=false)
 

Additional Inherited Members

- Public Types inherited from controller_interface::ControllerBase
typedef std::vector< hardware_interface::InterfaceResourcesClaimedResources
 
enum  ControllerState {
  ControllerState::CONSTRUCTED, ControllerState::INITIALIZED, ControllerState::RUNNING, ControllerState::STOPPED,
  ControllerState::WAITING, ControllerState::ABORTED
}
 
- Public Attributes inherited from controller_interface::ControllerBase
ControllerState state_
 
- Protected Member Functions inherited from controller_interface::MultiInterfaceController< hardware_interface::VelocityJointInterface, hardware_interface::EffortJointInterface >
bool initRequest (hardware_interface::RobotHW *robot_hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh, ClaimedResources &claimed_resources) override
 
- Static Protected Member Functions inherited from controller_interface::MultiInterfaceController< T >
static void clearClaims (hardware_interface::RobotHW *robot_hw)
 
static void extractInterfaceResources (hardware_interface::RobotHW *robot_hw_in, hardware_interface::RobotHW *robot_hw_out)
 
static bool hasRequiredInterfaces (hardware_interface::RobotHW *robot_hw)
 
static void populateClaimedResources (hardware_interface::RobotHW *robot_hw, ClaimedResources &claimed_resources)
 
- Static Protected Member Functions inherited from controller_interface::MultiInterfaceController< hardware_interface::VelocityJointInterface, hardware_interface::EffortJointInterface >
static void clearClaims (hardware_interface::RobotHW *robot_hw)
 
static void extractInterfaceResources (hardware_interface::RobotHW *robot_hw_in, hardware_interface::RobotHW *robot_hw_out)
 
static bool hasRequiredInterfaces (hardware_interface::RobotHW *robot_hw)
 
static void populateClaimedResources (hardware_interface::RobotHW *robot_hw, ClaimedResources &claimed_resources)
 
- Protected Attributes inherited from controller_interface::MultiInterfaceController< T >
bool allow_optional_interfaces_
 
hardware_interface::RobotHW robot_hw_ctrl_
 
- Protected Attributes inherited from controller_interface::MultiInterfaceController< hardware_interface::VelocityJointInterface, hardware_interface::EffortJointInterface >
bool allow_optional_interfaces_
 
hardware_interface::RobotHW robot_hw_ctrl_
 

Detailed Description

Definition at line 57 of file extensible_controllers.h.

Member Function Documentation

◆ helper()

int DerivedController::helper ( )
overridevirtual

Reimplemented from controller_manager_tests::ExtensibleController.

Definition at line 80 of file extensible_controllers.cpp.

◆ init()

bool DerivedController::init ( hardware_interface::RobotHW robot_hw,
ros::NodeHandle root_nh,
ros::NodeHandle controller_nh 
)
overridevirtual

Reimplemented from controller_manager_tests::ExtensibleController.

Definition at line 63 of file extensible_controllers.cpp.

◆ initRequest()

bool DerivedController::initRequest ( hardware_interface::RobotHW hw,
ros::NodeHandle nh,
ros::NodeHandle pnh,
controller_interface::ControllerBase::ClaimedResources cr 
)
overridevirtual

Implements controller_interface::ControllerBase.

Definition at line 56 of file extensible_controllers.cpp.


The documentation for this class was generated from the following files:


controller_manager_tests
Author(s): Vijay Pradeep, Adolfo Rodriguez Tsouroukdissian
autogenerated on Tue Oct 15 2024 02:08:24