add(const VectorMemberSharedPtr &l) | VectorHelper< Layer > | virtual |
call(FuncType func, Data &status) | VectorHelper< Layer > | protected |
call(FuncType func, Data &status) | VectorHelper< Layer > | protected |
call_or_fail(FuncType func, FailType fail, Data &status) | LayerGroup<> | protected |
call_or_fail_rev(FuncType func, FailType fail, Data &status) | LayerGroup<> | protected |
call_rev(FuncType func, Data &status) | VectorHelper< Layer > | protected |
call_rev(FuncType func, Data &status) | VectorHelper< Layer > | protected |
callFunc(FuncType func, Data &status) | VectorHelper< Layer > | |
cm_ | canopen::MotorChain | private |
destroy() | VectorHelper< Layer > | protected |
diag(LayerReport &report) | canopen::Layer | |
diag_mutex_ | canopen::RosChain | protected |
diag_timer_ | canopen::RosChain | protected |
diag_updater_ | canopen::RosChain | protected |
emcy_handlers_ | canopen::RosChain | protected |
Error | canopen::Layer | |
getLayerState() | canopen::Layer | |
Halt | canopen::Layer | |
halt(LayerStatus &status) | canopen::Layer | |
handle_get_object(canopen_chain_node::GetObject::Request &req, canopen_chain_node::GetObject::Response &res) | canopen::RosChain | protected |
handle_halt(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) | canopen::RosChain | protectedvirtual |
handle_init(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) | canopen::RosChain | protectedvirtual |
handle_recover(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) | canopen::RosChain | protectedvirtual |
handle_set_object(canopen_chain_node::SetObject::Request &req, canopen_chain_node::SetObject::Response &res) | canopen::RosChain | protected |
handle_shutdown(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) | canopen::RosChain | protectedvirtual |
handleDiag(LayerReport &report) | LayerGroup<> | protectedvirtual |
canopen::Layer::handleDiag(LayerReport &report)=0 | canopen::Layer | protectedpure virtual |
handleHalt(LayerStatus &status) | LayerGroup<> | protectedvirtual |
canopen::Layer::handleHalt(LayerStatus &status)=0 | canopen::Layer | protectedpure virtual |
handleInit(LayerStatus &status) | LayerGroup<> | protectedvirtual |
canopen::Layer::handleInit(LayerStatus &status)=0 | canopen::Layer | protectedpure virtual |
handleRead(LayerStatus &status, const LayerState ¤t_state) | LayerGroup<> | protectedvirtual |
canopen::Layer::handleRead(LayerStatus &status, const LayerState ¤t_state)=0 | canopen::Layer | protectedpure virtual |
handleRecover(LayerStatus &status) | LayerGroup<> | protectedvirtual |
canopen::Layer::handleRecover(LayerStatus &status)=0 | canopen::Layer | protectedpure virtual |
handleShutdown(LayerStatus &status) | canopen::RosChain | protectedvirtual |
LayerGroup<>::handleShutdown(LayerStatus &status) | LayerGroup<> | protectedvirtual |
handleWrite(LayerStatus &status, const LayerState ¤t_state) | canopen::RosChain | protectedvirtual |
LayerGroup<>::handleWrite(LayerStatus &status, const LayerState ¤t_state) | LayerGroup<> | protectedvirtual |
hb_sender_ | canopen::RosChain | protected |
heartbeat_timer_ | canopen::RosChain | protected |
Init | canopen::Layer | |
init(LayerStatus &status) | canopen::Layer | |
interface_ | canopen::RosChain | protected |
Layer(const std::string &n) | canopen::Layer | |
LayerGroup(const std::string &n) | LayerGroup<> | |
LayerStack(const std::string &n) | canopen::LayerStack | |
LayerState enum name | canopen::Layer | |
loggers_ | canopen::RosChain | protected |
logState(const can::State &s) | canopen::RosChain | protected |
master_ | canopen::RosChain | protected |
motor_allocator_ | canopen::MotorChain | private |
MotorChain(const ros::NodeHandle &nh, const ros::NodeHandle &nh_priv) | canopen::MotorChain | |
motors_ | canopen::MotorChain | private |
mutex_ | canopen::RosChain | protected |
name | canopen::Layer | |
nh_ | canopen::RosChain | protected |
nh_priv_ | canopen::RosChain | protected |
nodeAdded(XmlRpc::XmlRpcValue ¶ms, const canopen::NodeSharedPtr &node, const LoggerSharedPtr &logger) | canopen::MotorChain | privatevirtual |
nodes_ | canopen::RosChain | protected |
nodes_lookup_ | canopen::RosChain | protected |
Off | canopen::Layer | |
publishers_ | canopen::RosChain | protected |
read(LayerStatus &status) | canopen::Layer | |
Ready | canopen::Layer | |
Recover | canopen::Layer | |
recover(LayerStatus &status) | canopen::Layer | |
report_diagnostics(diagnostic_updater::DiagnosticStatusWrapper &stat) | canopen::RosChain | protected |
reset_errors_before_recover_ | canopen::RosChain | protected |
robot_layer_ | canopen::MotorChain | private |
RosChain(const ros::NodeHandle &nh, const ros::NodeHandle &nh_priv) | canopen::RosChain | |
run() | canopen::RosChain | protected |
running_ | canopen::RosChain | protected |
setup() | canopen::RosChain | |
setup_bus() | canopen::RosChain | protected |
setup_chain() | canopen::MotorChain | virtual |
setup_heartbeat() | canopen::RosChain | protected |
setup_nodes() | canopen::RosChain | protected |
setup_sync() | canopen::RosChain | protected |
Shutdown | canopen::Layer | |
shutdown(LayerStatus &status) | canopen::Layer | |
srv_get_object_ | canopen::RosChain | protected |
srv_halt_ | canopen::RosChain | protected |
srv_init_ | canopen::RosChain | protected |
srv_recover_ | canopen::RosChain | protected |
srv_set_object_ | canopen::RosChain | protected |
srv_shutdown_ | canopen::RosChain | protected |
state_listener_ | canopen::RosChain | protected |
sync_ | canopen::RosChain | protected |
thread_ | canopen::RosChain | protected |
update_duration_ | canopen::RosChain | protected |
vector_type typedef | VectorHelper< Layer > | protected |
VectorMemberSharedPtr typedef | VectorHelper< Layer > | |
write(LayerStatus &status) | canopen::Layer | |
~Layer() | canopen::Layer | virtual |
~RosChain() | canopen::RosChain | virtual |