Public Member Functions | Private Types | Private Attributes | List of all members
tof_sensor_controller::Controller Class Reference

#include <tof_sensor_controller.h>

Inheritance diagram for tof_sensor_controller::Controller:
Inheritance graph
[legend]

Public Member Functions

 Controller ()=default
 
bool init (rm_control::TofSensorInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh) override
 
void update (const ros::Time &time, const ros::Duration &period) override
 
- Public Member Functions inherited from controller_interface::Controller< rm_control::TofSensorInterface >
virtual bool init (T *, ros::NodeHandle &)
 
virtual bool init (T *, ros::NodeHandle &, ros::NodeHandle &)
 
- 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
 

Private Types

typedef std::shared_ptr< realtime_tools::RealtimePublisher< rm_msgs::TofSensor > > RtpublisherPtr
 

Private Attributes

std::vector< RtpublisherPtrrealtime_pubs_
 
RtpublisherPtr tof_pub_
 
rm_control::TofSensorHandle tof_sensor_handle
 
std::vector< rm_control::TofSensorHandletof_sensors_
 

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::Controller< rm_control::TofSensorInterface >
std::string getHardwareInterfaceType () const
 
bool initRequest (hardware_interface::RobotHW *robot_hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh, ClaimedResources &claimed_resources) override
 

Detailed Description

Definition at line 15 of file tof_sensor_controller.h.

Member Typedef Documentation

◆ RtpublisherPtr

typedef std::shared_ptr<realtime_tools::RealtimePublisher<rm_msgs::TofSensor> > tof_sensor_controller::Controller::RtpublisherPtr
private

Definition at line 27 of file tof_sensor_controller.h.

Constructor & Destructor Documentation

◆ Controller()

tof_sensor_controller::Controller::Controller ( )
default

Member Function Documentation

◆ init()

bool tof_sensor_controller::Controller::init ( rm_control::TofSensorInterface hw,
ros::NodeHandle root_nh,
ros::NodeHandle controller_nh 
)
override

Definition at line 10 of file tof_sensor_controller.cpp.

◆ update()

void tof_sensor_controller::Controller::update ( const ros::Time time,
const ros::Duration period 
)
overridevirtual

Implements controller_interface::ControllerBase.

Definition at line 29 of file tof_sensor_controller.cpp.

Member Data Documentation

◆ realtime_pubs_

std::vector<RtpublisherPtr> tof_sensor_controller::Controller::realtime_pubs_
private

Definition at line 29 of file tof_sensor_controller.h.

◆ tof_pub_

RtpublisherPtr tof_sensor_controller::Controller::tof_pub_
private

Definition at line 28 of file tof_sensor_controller.h.

◆ tof_sensor_handle

rm_control::TofSensorHandle tof_sensor_controller::Controller::tof_sensor_handle
private

Definition at line 25 of file tof_sensor_controller.h.

◆ tof_sensors_

std::vector<rm_control::TofSensorHandle> tof_sensor_controller::Controller::tof_sensors_
private

Definition at line 26 of file tof_sensor_controller.h.


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


tof_sensor_controller
Author(s):
autogenerated on Fri Jun 10 2022 02:55:54