17 #include <nav_msgs/OccupancyGrid.h> 18 #include <nav_msgs/Path.h> 19 #include <mrpt_msgs/GraphSlamAgents.h> 20 #include <mrpt/maps/COccupancyGridMap2D.h> 21 #include <mrpt/maps/CSimplePointsMap.h> 26 #include <mrpt/math/utils.h> 32 #include <mrpt/version.h> 33 #if MRPT_VERSION>=0x199 34 #include <mrpt/system/COutputLogger.h> 35 #include <mrpt/img/TColorManager.h> 37 using namespace mrpt::img;
50 namespace mrpt {
namespace graphslam {
61 typedef std::map<TNeighborAgentMapProps*, COccupancyGridMap2D::Ptr>
maps_t;
71 mrpt::utils::COutputLogger* logger_in,
std::vector< TNeighborAgentMapProps * > neighbors_t
Class responsible of the execution of the map_merger_node.
std::string quit_keypress1
std::map< TNeighborAgentMapProps *, CWindowManager * > m_neighbors_to_windows
const mrpt::poses::CPose3D EMPTY_POSE
bool save_map_merging_results
std::string m_feedback_ns
std::string map_merge_keypress
mrpt::slam::CGridMapAligner::TConfigParams m_alignment_options
mrpt::graphslam::detail::CConnectionManager m_conn_manager
std::map< TNeighborAgentMapProps *, COccupancyGridMap2D::Ptr > maps_t
std::string m_global_ns
Topic namespace under which current node is going to be publishing.
mrpt::graphslam::CWindowManager * m_fused_map_win_manager
neighbors_t m_neighbors
CConnectionManager instance for fetching the running graphSLAM agents.
std::map< TNeighborAgentMapProps *, mrpt::opengl::CSetOfLines::Ptr > trajectories_t
Robot trajectory visual object type.
Struct holding a COccupancyGridMap2D (as well as subscribers for updating it) for a specific running ...
std::map< TNeighborAgentMapProps *, mrpt::poses::CPose2D > neighbor_to_rel_pose_t
std::string quit_keypress2
mrpt::utils::COutputLogger * m_logger
std::map< TNeighborAgentMapProps *, bool > neighbor_to_is_used_t
std::string m_options_ns
Topic namespace under which, options that are used during the map alignment procedure are fetched fro...
Class responsible of handling the network communication between SLAM agents in the Multi-Robot graphS...