10 #include <nav_msgs/OccupancyGrid.h> 11 #include <nav_msgs/Path.h> 12 #include <mrpt_msgs/GraphSlamAgents.h> 13 #include <mrpt/utils/COutputLogger.h> 14 #include <mrpt/maps/COccupancyGridMap2D.h> 15 #include <mrpt_bridge/map.h> 37 int main(
int argc,
char **argv)
40 std::string node_name =
"map_merger";
47 logger.setLoggerName(node_name);
48 logger.setMinLoggingLevel(LVL_DEBUG);
49 logger.logFmt(LVL_WARN,
"Initialized %s node...\n", node_name.c_str());
53 bool continue_exec =
true;
54 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()