#include <robot_layer.h>
Public Member Functions | |
ControllerManagerLayer (const boost::shared_ptr< RobotLayer > robot, const ros::NodeHandle &nh, const ros::Duration &fixed_period) | |
virtual void | handleDiag (canopen::LayerReport &report) |
virtual void | handleHalt (canopen::LayerStatus &status) |
virtual void | handleInit (canopen::LayerStatus &status) |
virtual void | handleRead (canopen::LayerStatus &status, const LayerState ¤t_state) |
virtual void | handleRecover (canopen::LayerStatus &status) |
virtual void | handleShutdown (canopen::LayerStatus &status) |
virtual void | handleWrite (canopen::LayerStatus &status, const LayerState ¤t_state) |
Private Attributes | |
boost::shared_ptr < controller_manager::ControllerManager > | cm_ |
const ros::Duration | fixed_period_ |
canopen::time_point | last_time_ |
ros::NodeHandle | nh_ |
boost::atomic< bool > | recover_ |
boost::shared_ptr< RobotLayer > | robot_ |
Definition at line 260 of file robot_layer.h.
ControllerManagerLayer::ControllerManagerLayer | ( | const boost::shared_ptr< RobotLayer > | robot, |
const ros::NodeHandle & | nh, | ||
const ros::Duration & | fixed_period | ||
) | [inline] |
Definition at line 270 of file robot_layer.h.
virtual void ControllerManagerLayer::handleDiag | ( | canopen::LayerReport & | report | ) | [inline, virtual] |
Implements canopen::Layer.
Definition at line 275 of file robot_layer.h.
virtual void ControllerManagerLayer::handleHalt | ( | canopen::LayerStatus & | status | ) | [inline, virtual] |
Implements canopen::Layer.
Definition at line 276 of file robot_layer.h.
void ControllerManagerLayer::handleInit | ( | canopen::LayerStatus & | status | ) | [virtual] |
Implements canopen::Layer.
Definition at line 508 of file robot_layer.cpp.
void ControllerManagerLayer::handleRead | ( | canopen::LayerStatus & | status, |
const LayerState & | current_state | ||
) | [virtual] |
Implements canopen::Layer.
Definition at line 479 of file robot_layer.cpp.
void ControllerManagerLayer::handleRecover | ( | canopen::LayerStatus & | status | ) | [virtual] |
Implements canopen::Layer.
Definition at line 518 of file robot_layer.cpp.
void ControllerManagerLayer::handleShutdown | ( | canopen::LayerStatus & | status | ) | [virtual] |
Implements canopen::Layer.
Definition at line 523 of file robot_layer.cpp.
void ControllerManagerLayer::handleWrite | ( | canopen::LayerStatus & | status, |
const LayerState & | current_state | ||
) | [virtual] |
Implements canopen::Layer.
Definition at line 485 of file robot_layer.cpp.
boost::shared_ptr<controller_manager::ControllerManager> ControllerManagerLayer::cm_ [private] |
Definition at line 261 of file robot_layer.h.
const ros::Duration ControllerManagerLayer::fixed_period_ [private] |
Definition at line 267 of file robot_layer.h.
Definition at line 265 of file robot_layer.h.
ros::NodeHandle ControllerManagerLayer::nh_ [private] |
Definition at line 263 of file robot_layer.h.
boost::atomic<bool> ControllerManagerLayer::recover_ [private] |
Definition at line 266 of file robot_layer.h.
boost::shared_ptr<RobotLayer> ControllerManagerLayer::robot_ [private] |
Definition at line 262 of file robot_layer.h.