Public Member Functions | |
| virtual void | bb_interface_data_changed (fawkes::Interface *interface) throw () |
| void | finalize () |
| void | init () |
| RcllFawkesSimNode (ros::NodeHandle rn, std::shared_ptr< fawkes::BlackBoard > bb) | |
| bool | srv_cb_navgraph_gen (rcll_fawkes_sim_msgs::NavgraphWithMPSGenerate::Request &req, rcll_fawkes_sim_msgs::NavgraphWithMPSGenerate::Response &res) |
Private Attributes | |
| std::shared_ptr < fawkes::BlackBoard > | blackboard_ |
| fawkes::RobotinoLightInterface * | ifc_machine_signal_ |
| fawkes::NavGraphWithMPSGeneratorInterface * | ifc_navgraph_gen_ |
| fawkes::Position3DInterface * | ifc_pose_ |
| fawkes::TagVisionInterface * | ifc_tag_vision_ |
| fawkes::ZoneInterface * | ifc_zone_ |
| std::array < fawkes::Position3DInterface *, 16 > | ifcs_tag_pos_ |
| ros::Publisher | pub_expl_zone_info_ |
| ros::Publisher | pub_mps_light_state_ |
| ros::Publisher | pub_mps_marker_array_ |
| ros::Publisher | pub_pose_ |
| ros::NodeHandle | rosnode |
| ros::ServiceServer | srv_navgraph_gen_ |
Definition at line 75 of file rcll_fawkes_sim_node.cpp.
| RcllFawkesSimNode::RcllFawkesSimNode | ( | ros::NodeHandle | rn, |
| std::shared_ptr< fawkes::BlackBoard > | bb | ||
| ) | [inline] |
Definition at line 78 of file rcll_fawkes_sim_node.cpp.
| virtual void RcllFawkesSimNode::bb_interface_data_changed | ( | fawkes::Interface * | interface | ) | throw () [inline, virtual] |
Definition at line 143 of file rcll_fawkes_sim_node.cpp.
| void RcllFawkesSimNode::finalize | ( | ) | [inline] |
Definition at line 123 of file rcll_fawkes_sim_node.cpp.
| void RcllFawkesSimNode::init | ( | ) | [inline] |
Definition at line 84 of file rcll_fawkes_sim_node.cpp.
| bool RcllFawkesSimNode::srv_cb_navgraph_gen | ( | rcll_fawkes_sim_msgs::NavgraphWithMPSGenerate::Request & | req, |
| rcll_fawkes_sim_msgs::NavgraphWithMPSGenerate::Response & | res | ||
| ) | [inline] |
Definition at line 218 of file rcll_fawkes_sim_node.cpp.
std::shared_ptr<fawkes::BlackBoard> RcllFawkesSimNode::blackboard_ [private] |
Definition at line 331 of file rcll_fawkes_sim_node.cpp.
fawkes::RobotinoLightInterface* RcllFawkesSimNode::ifc_machine_signal_ [private] |
Definition at line 336 of file rcll_fawkes_sim_node.cpp.
fawkes::NavGraphWithMPSGeneratorInterface* RcllFawkesSimNode::ifc_navgraph_gen_ [private] |
Definition at line 337 of file rcll_fawkes_sim_node.cpp.
fawkes::Position3DInterface* RcllFawkesSimNode::ifc_pose_ [private] |
Definition at line 338 of file rcll_fawkes_sim_node.cpp.
fawkes::TagVisionInterface* RcllFawkesSimNode::ifc_tag_vision_ [private] |
Definition at line 334 of file rcll_fawkes_sim_node.cpp.
fawkes::ZoneInterface* RcllFawkesSimNode::ifc_zone_ [private] |
Definition at line 333 of file rcll_fawkes_sim_node.cpp.
std::array<fawkes::Position3DInterface *, 16> RcllFawkesSimNode::ifcs_tag_pos_ [private] |
Definition at line 335 of file rcll_fawkes_sim_node.cpp.
Definition at line 340 of file rcll_fawkes_sim_node.cpp.
Definition at line 342 of file rcll_fawkes_sim_node.cpp.
Definition at line 341 of file rcll_fawkes_sim_node.cpp.
ros::Publisher RcllFawkesSimNode::pub_pose_ [private] |
Definition at line 343 of file rcll_fawkes_sim_node.cpp.
ros::NodeHandle RcllFawkesSimNode::rosnode [private] |
Definition at line 329 of file rcll_fawkes_sim_node.cpp.
Definition at line 344 of file rcll_fawkes_sim_node.cpp.