11 #include <nav_msgs/OccupancyGrid.h> 12 #include <nav_msgs/Path.h> 13 #include <mrpt_msgs/GraphSlamAgents.h> 14 #include <mrpt/system/COutputLogger.h> 15 #include <mrpt/maps/COccupancyGridMap2D.h> 16 #include <mrpt/ros1bridge/map.h> 35 int main(
int argc,
char** argv)
38 std::string node_name =
"map_merger";
45 logger.setLoggerName(node_name);
46 logger.setMinLoggingLevel(LVL_DEBUG);
47 logger.logFmt(LVL_WARN,
"Initialized %s node...\n", node_name.c_str());
51 bool continue_exec =
true;
52 while (
ros::ok() && continue_exec)
Class responsible of the execution of the map_merger_node.
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
int main(int argc, char **argv)
Node that fetches the local maps produced by the graphSLAM agents and joins them together using a RAN...
bool updateState()
Query and fetch the list of new graphSLAM agents.
ROSCPP_DECL void spinOnce()