2 #ifndef CANOPEN_MOTOR_NODE_CONTROLLER_MANAGER_LAYER_H_ 3 #define CANOPEN_MOTOR_NODE_CONTROLLER_MANAGER_LAYER_H_ 6 #include <boost/shared_ptr.hpp> 7 #include <boost/atomic.hpp> 13 class ControllerManager;
29 :
Layer(
"ControllerManager"), robot_(robot), nh_(nh), fixed_period_(fixed_period) {
ControllerManagerLayer(const canopen::RobotLayerSharedPtr robot, const ros::NodeHandle &nh, const ros::Duration &fixed_period)
virtual void handleDiag(canopen::LayerReport &report)
canopen::time_point last_time_
boost::atomic< bool > recover_
const ros::Duration fixed_period_
boost::chrono::high_resolution_clock::time_point time_point
virtual void handleHalt(canopen::LayerStatus &status)
boost::shared_ptr< controller_manager::ControllerManager > cm_
canopen::RobotLayerSharedPtr robot_