Public Member Functions | |
MotorChain (const ros::NodeHandle &nh, const ros::NodeHandle &nh_priv) | |
virtual bool | setup_chain () |
Private Member Functions | |
virtual bool | nodeAdded (XmlRpc::XmlRpcValue ¶ms, const boost::shared_ptr< canopen::Node > &node, const boost::shared_ptr< Logger > &logger) |
Private Attributes | |
boost::shared_ptr < ControllerManagerLayer > | cm_ |
ClassAllocator < canopen::MotorBase > | motor_allocator_ |
boost::shared_ptr < LayerGroupNoDiag< MotorBase > > | motors_ |
boost::shared_ptr< RobotLayer > | robot_layer_ |
Definition at line 31 of file control_node.cpp.
MotorChain::MotorChain | ( | const ros::NodeHandle & | nh, |
const ros::NodeHandle & | nh_priv | ||
) | [inline] |
Definition at line 90 of file control_node.cpp.
virtual bool MotorChain::nodeAdded | ( | XmlRpc::XmlRpcValue & | params, |
const boost::shared_ptr< canopen::Node > & | node, | ||
const boost::shared_ptr< Logger > & | logger | ||
) | [inline, private, virtual] |
Reimplemented from canopen::RosChain.
Definition at line 38 of file control_node.cpp.
virtual bool MotorChain::setup_chain | ( | ) | [inline, virtual] |
Reimplemented from canopen::RosChain.
Definition at line 92 of file control_node.cpp.
boost::shared_ptr< ControllerManagerLayer> MotorChain::cm_ [private] |
Definition at line 36 of file control_node.cpp.
Definition at line 32 of file control_node.cpp.
boost::shared_ptr< LayerGroupNoDiag<MotorBase> > MotorChain::motors_ [private] |
Definition at line 33 of file control_node.cpp.
boost::shared_ptr<RobotLayer> MotorChain::robot_layer_ [private] |
Definition at line 34 of file control_node.cpp.