ROSAgent.h
Go to the documentation of this file.
1 
7 #include<vector>
8 #include <sstream>
9 
10 #include "ros/ros.h"
11 #include "ORCAAgent.h"
12 #include "Const.h"
13 #include "ORCAStar/Init.h"
14 #include "ORCAStar/ORCAInput.h"
15 #include "geometry_msgs/Point32.h"
16 #include "nav_msgs/OccupancyGrid.h"
17 #include "nav_msgs/GetMap.h"
18 
19 #ifndef ROSAGENT_H
20 #define ROSAGENT_H
21 
60 class ROSAgent
61 {
62 
63 public:
64 
68  ROSAgent() = default;
69 
76  ROSAgent(size_t id);
77 
81  ~ROSAgent() = default;
82 
83 
90  void DoStep(const ORCAStar::ORCAInput &msg);
91 
92 
93 private:
95  size_t agentId;
96  ORCAAgent *agent;
97  std::vector<Agent *> neighbous;
98 
99 
100  ros::NodeHandle n;
101  ros::Publisher ROSAgentPub;
102  ros::Subscriber ROSAgentSub;
103 
104  EnvironmentOptions *options;
105  AgentParam *param;
106  Map *map;
107 
109 
110 
111 
112 };
113 
114 #endif // ROSAGENT_H
ROSAgent()=default
Class AgentParam contains agent and algoritms parameters.
Definition: Agent.h:38
~ROSAgent()=default
Class EnvironmentOptions contains environment and algoritms parameters.
Map class describes static environment.
Definition: Map.h:36
File contains ORCAAgent class.
File contains main constants.
ORCAAgent class implements agent with ORCA algoritm behavior.
Definition: ORCAAgent.h:26
Class is an implementation of single agent navigation ROS module based on ORCAStar algorithm...
Definition: ROSAgent.h:60
void DoStep(const ORCAStar::ORCAInput &msg)
Definition: ROSAgent.cpp:119


ORCAStar
Author(s): Stepan Drgachev
autogenerated on Wed Jul 15 2020 16:13:14