#include <runtime_core.h>
Public Member Functions | |
| void | barrier_check (const ros::TimerEvent &) |
| void | initialize () |
| void | publish_robot_base (const ros::TimerEvent &) |
| void | publish_swarm_list (const ros::TimerEvent &) |
| RuntimeCore () | |
| void | setParameters () |
| void | shutdown () |
| void | spin_msg_queue () |
| ~RuntimeCore () | |
Public Attributes | |
| boost::shared_ptr< AppManager > | app_manager_ |
| ros::Timer | barrier_timer_ |
| pluginlib::ClassLoader < micros_swarm::CommInterface > | ci_loader_ |
| std::string | comm_type_ |
| boost::shared_ptr< CommInterface > | communicator_ |
| double | default_neighbor_distance_ |
| boost::shared_ptr < micros_swarm::MsgQueueManager > | msg_queue_manager_ |
| ros::NodeHandle | node_handle_ |
| boost::shared_ptr < micros_swarm::PacketParser > | parser_ |
| double | publish_robot_base_duration_ |
| ros::Timer | publish_robot_base_timer_ |
| double | publish_swarm_list_duration_ |
| ros::Timer | publish_swarm_list_timer_ |
| int | robot_id_ |
| boost::shared_ptr< RuntimeHandle > | rth_ |
| boost::thread * | spin_thread_ |
| ros::Timer | spin_timer_ |
| int | total_robot_numbers_ |
| int | worker_num_ |
Definition at line 42 of file runtime_core.h.
Definition at line 26 of file runtime_core.cpp.
Definition at line 27 of file runtime_core.cpp.
| void micros_swarm::RuntimeCore::barrier_check | ( | const ros::TimerEvent & | ) |
Definition at line 40 of file runtime_core.cpp.
Definition at line 171 of file runtime_core.cpp.
| void micros_swarm::RuntimeCore::publish_robot_base | ( | const ros::TimerEvent & | ) |
Definition at line 67 of file runtime_core.cpp.
| void micros_swarm::RuntimeCore::publish_swarm_list | ( | const ros::TimerEvent & | ) |
Definition at line 94 of file runtime_core.cpp.
Definition at line 117 of file runtime_core.cpp.
| void micros_swarm::RuntimeCore::shutdown | ( | ) |
Definition at line 205 of file runtime_core.cpp.
Definition at line 29 of file runtime_core.cpp.
| boost::shared_ptr<AppManager> micros_swarm::RuntimeCore::app_manager_ |
Definition at line 52 of file runtime_core.h.
Definition at line 56 of file runtime_core.h.
Definition at line 49 of file runtime_core.h.
| std::string micros_swarm::RuntimeCore::comm_type_ |
Definition at line 48 of file runtime_core.h.
| boost::shared_ptr<CommInterface> micros_swarm::RuntimeCore::communicator_ |
Definition at line 47 of file runtime_core.h.
Definition at line 61 of file runtime_core.h.
| boost::shared_ptr<micros_swarm::MsgQueueManager> micros_swarm::RuntimeCore::msg_queue_manager_ |
Definition at line 50 of file runtime_core.h.
Definition at line 45 of file runtime_core.h.
| boost::shared_ptr<micros_swarm::PacketParser> micros_swarm::RuntimeCore::parser_ |
Definition at line 51 of file runtime_core.h.
Definition at line 59 of file runtime_core.h.
Definition at line 54 of file runtime_core.h.
Definition at line 60 of file runtime_core.h.
Definition at line 55 of file runtime_core.h.
Definition at line 63 of file runtime_core.h.
| boost::shared_ptr<RuntimeHandle> micros_swarm::RuntimeCore::rth_ |
Definition at line 46 of file runtime_core.h.
| boost::thread* micros_swarm::RuntimeCore::spin_thread_ |
Definition at line 66 of file runtime_core.h.
Definition at line 57 of file runtime_core.h.
Definition at line 62 of file runtime_core.h.
Definition at line 64 of file runtime_core.h.