controller_manager_layer.h
Go to the documentation of this file.
1 
2 #ifndef CANOPEN_MOTOR_NODE_CONTROLLER_MANAGER_LAYER_H_
3 #define CANOPEN_MOTOR_NODE_CONTROLLER_MANAGER_LAYER_H_
4 
5 #include <ros/node_handle.h>
6 #include <boost/shared_ptr.hpp>
7 #include <boost/atomic.hpp>
10 
11 // forward declarations
12 namespace controller_manager {
13  class ControllerManager;
14 }
15 
16 namespace canopen {
17 
22 
24  boost::atomic<bool> recover_;
26 
27 public:
29  :Layer("ControllerManager"), robot_(robot), nh_(nh), fixed_period_(fixed_period) {
30  }
31 
32  virtual void handleRead(canopen::LayerStatus &status, const LayerState &current_state);
33  virtual void handleWrite(canopen::LayerStatus &status, const LayerState &current_state);
34  virtual void handleDiag(canopen::LayerReport &report) { /* nothing to do */ }
35  virtual void handleHalt(canopen::LayerStatus &status) { /* nothing to do (?) */ }
36  virtual void handleInit(canopen::LayerStatus &status);
37  virtual void handleRecover(canopen::LayerStatus &status);
38  virtual void handleShutdown(canopen::LayerStatus &status);
39 };
40 
41 } // namespace canopen
42 
43 #endif /* CANOPEN_MOTOR_NODE_CONTROLLER_MANAGER_LAYER_H_ */
ControllerManagerLayer(const canopen::RobotLayerSharedPtr robot, const ros::NodeHandle &nh, const ros::Duration &fixed_period)
virtual void handleDiag(canopen::LayerReport &report)
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_


canopen_motor_node
Author(s): Mathias Lüdtke
autogenerated on Sat May 4 2019 02:40:47