Public Member Functions | Protected Member Functions | Protected Attributes | Private Attributes | List of all members
usb_cam_controllers::SimplePacketController Class Referenceabstract

#include <simple_packet_controller.hpp>

Inheritance diagram for usb_cam_controllers::SimplePacketController:
Inheritance graph
[legend]

Public Member Functions

virtual bool init (usb_cam_hardware_interface::PacketInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)
 
 SimplePacketController ()
 
virtual void starting (const ros::Time &time)
 
virtual void stopping (const ros::Time &time)
 
virtual void update (const ros::Time &time, const ros::Duration &period)
 
virtual ~SimplePacketController ()
 
- Public Member Functions inherited from controller_interface::Controller< usb_cam_hardware_interface::PacketInterface >
 Controller ()
 
virtual bool init (usb_cam_hardware_interface::PacketInterface *, ros::NodeHandle &)
 
virtual ~Controller ()
 
- Public Member Functions inherited from controller_interface::ControllerBase
 ControllerBase ()
 
bool isRunning ()
 
bool isRunning ()
 
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 ~ControllerBase ()
 

Protected Member Functions

virtual bool initImpl (usb_cam_hardware_interface::PacketInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)=0
 
virtual void startingImpl (const ros::Time &time)=0
 
virtual void stoppingImpl (const ros::Time &time)=0
 
virtual void updateImpl (const ros::Time &time, const ros::Duration &period)=0
 
- Protected Member Functions inherited from controller_interface::Controller< usb_cam_hardware_interface::PacketInterface >
std::string getHardwareInterfaceType () const
 
virtual bool initRequest (hardware_interface::RobotHW *robot_hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh, ClaimedResources &claimed_resources)
 

Protected Attributes

usb_cam_hardware_interface::PacketHandle packet_iface_
 

Private Attributes

ros::Time last_stamp_
 

Additional Inherited Members

- Public Types inherited from controller_interface::ControllerBase
typedef std::vector< hardware_interface::InterfaceResourcesClaimedResources
 
- Public Attributes inherited from controller_interface::ControllerBase
 CONSTRUCTED
 
 INITIALIZED
 
 RUNNING
 
enum controller_interface::ControllerBase:: { ... }  state_
 

Detailed Description

Definition at line 19 of file simple_packet_controller.hpp.

Constructor & Destructor Documentation

usb_cam_controllers::SimplePacketController::SimplePacketController ( )
inline

Definition at line 22 of file simple_packet_controller.hpp.

virtual usb_cam_controllers::SimplePacketController::~SimplePacketController ( )
inlinevirtual

Definition at line 24 of file simple_packet_controller.hpp.

Member Function Documentation

virtual bool usb_cam_controllers::SimplePacketController::init ( usb_cam_hardware_interface::PacketInterface hw,
ros::NodeHandle root_nh,
ros::NodeHandle controller_nh 
)
inlinevirtual
virtual bool usb_cam_controllers::SimplePacketController::initImpl ( usb_cam_hardware_interface::PacketInterface hw,
ros::NodeHandle root_nh,
ros::NodeHandle controller_nh 
)
protectedpure virtual
virtual void usb_cam_controllers::SimplePacketController::starting ( const ros::Time time)
inlinevirtual

Reimplemented from controller_interface::ControllerBase.

Definition at line 50 of file simple_packet_controller.hpp.

virtual void usb_cam_controllers::SimplePacketController::startingImpl ( const ros::Time time)
protectedpure virtual
virtual void usb_cam_controllers::SimplePacketController::stopping ( const ros::Time time)
inlinevirtual

Reimplemented from controller_interface::ControllerBase.

Definition at line 69 of file simple_packet_controller.hpp.

virtual void usb_cam_controllers::SimplePacketController::stoppingImpl ( const ros::Time time)
protectedpure virtual
virtual void usb_cam_controllers::SimplePacketController::update ( const ros::Time time,
const ros::Duration period 
)
inlinevirtual

Implements controller_interface::ControllerBase.

Definition at line 52 of file simple_packet_controller.hpp.

virtual void usb_cam_controllers::SimplePacketController::updateImpl ( const ros::Time time,
const ros::Duration period 
)
protectedpure virtual

Member Data Documentation

ros::Time usb_cam_controllers::SimplePacketController::last_stamp_
private

Definition at line 88 of file simple_packet_controller.hpp.

usb_cam_hardware_interface::PacketHandle usb_cam_controllers::SimplePacketController::packet_iface_
protected

Definition at line 85 of file simple_packet_controller.hpp.


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


usb_cam_controllers
Author(s):
autogenerated on Tue Jul 14 2020 03:12:08