Go to the documentation of this file.
18 #include <nav_msgs/OccupancyGrid.h>
19 #include <nav_msgs/Path.h>
20 #include <mrpt_msgs/GraphSlamAgents.h>
21 #include <mrpt/maps/COccupancyGridMap2D.h>
22 #include <mrpt/maps/CSimplePointsMap.h>
23 #include <mrpt/slam/CGridMapAligner.h>
24 #include <mrpt/ros1bridge/map.h>
25 #include <mrpt/system/filesystem.h>
26 #include <mrpt/system/os.h>
27 #include <mrpt/math/utils.h>
28 #include <mrpt/graphslam/misc/CWindowManager.h>
29 #include <mrpt/opengl/CAxis.h>
30 #include <mrpt/opengl/CGridPlaneXY.h>
31 #include <mrpt/opengl/CSetOfLines.h>
32 #include <mrpt/opengl/COpenGLScene.h>
33 #include <mrpt/system/COutputLogger.h>
34 #include <mrpt/img/TColorManager.h>
40 using namespace mrpt::system;
41 using namespace mrpt::img;
42 using namespace mrpt::maps;
43 using namespace mrpt::obs;
58 typedef std::map<TNeighborAgentMapProps*, COccupancyGridMap2D::Ptr>
maps_t;
60 typedef std::map<TNeighborAgentMapProps*, mrpt::poses::CPose2D>
64 typedef std::map<TNeighborAgentMapProps*, mrpt::opengl::CSetOfLines::Ptr>
80 void monitorKeystrokes(mrpt::graphslam::CWindowObserver* win_observer);
81 void initWindowVisuals(mrpt::graphslam::CWindowManager* win_manager);
82 mrpt::graphslam::CWindowManager* initWindowVisuals();
std::map< TNeighborAgentMapProps *, mrpt::opengl::CSetOfLines::Ptr > trajectories_t
Robot trajectory visual object type.
std::map< TNeighborAgentMapProps *, COccupancyGridMap2D::Ptr > maps_t
mrpt::system::COutputLogger * m_logger
std::string m_global_ns
Topic namespace under which current node is going to be publishing.
std::string m_options_ns
Topic namespace under which, options that are used during the map alignment procedure are fetched fro...
std::map< TNeighborAgentMapProps *, bool > neighbor_to_is_used_t
mrpt::graphslam::detail::CConnectionManager m_conn_manager
bool save_map_merging_results
const mrpt::poses::CPose3D EMPTY_POSE
std::vector< TNeighborAgentMapProps * > neighbors_t
std::string map_merge_keypress
Class responsible of handling the network communication between SLAM agents in the Multi-Robot graphS...
std::map< TNeighborAgentMapProps *, CWindowManager * > m_neighbors_to_windows
Class responsible of the execution of the map_merger_node.
std::string quit_keypress2
mrpt::graphslam::CWindowManager * m_fused_map_win_manager
std::string quit_keypress1
mrpt::slam::CGridMapAligner::TConfigParams m_alignment_options
std::map< TNeighborAgentMapProps *, mrpt::poses::CPose2D > neighbor_to_rel_pose_t
neighbors_t m_neighbors
CConnectionManager instance for fetching the running graphSLAM agents.
std::string m_feedback_ns