multi_robot_goal_generator.h
Go to the documentation of this file.
1 #ifndef TUW_RANDOM_GOAL_GENERATOR_NODE_H
2 #define TUW_RANDOM_GOAL_GENERATOR_NODE_H
3 
4 #include <ros/ros.h>
5 #include "nav_msgs/OccupancyGrid.h"
6 #include "tuw_multi_robot_msgs/RobotGoalsArray.h"
7 #include "tuw_geometry/grid_map.h"
8 
13 public:
15  void publish ();
16  void callback(const nav_msgs::OccupancyGrid::ConstPtr& msg);
17 private:
23  tuw::GridMap<int8_t> map_;
24  tuw::GridMap<int8_t> map_goals_;
30  std::string robot_name_prefix_;
31  std::string frame_id_;
32  tuw_multi_robot_msgs::RobotGoalsArray robot_goals_array_;
33  nav_msgs::OccupancyGrid msg_map_goals_;
34  nav_msgs::OccupancyGrid::ConstPtr msg_map_;
35 
36  void updateNrOfRobots(size_t nr_of_robots);
37 
38 };
39 
40 #endif // TUW_RANDOM_GOAL_GENERATOR_NODE_H
41 
double distance_between_robots_
parameter [m]
int nr_of_avaliable_robots_
retries/max_resample steps to find a free spot for a goal [m]
void callback(const nav_msgs::OccupancyGrid::ConstPtr &msg)
publishes the motion commands
tuw_multi_robot_msgs::RobotGoalsArray robot_goals_array_
parameter
nav_msgs::OccupancyGrid msg_map_goals_
tuw::GridMap< int8_t > map_goals_
std::string robot_name_prefix_
parameter [m]
void updateNrOfRobots(size_t nr_of_robots)
std::string frame_id_
parameter
nav_msgs::OccupancyGrid::ConstPtr msg_map_
double distance_to_map_border_
parameter [m]
double distance_boundary_
parameter count


tuw_multi_robot_goal_generator
Author(s):
autogenerated on Mon Jun 10 2019 15:42:34