CLoopCloserERD_MR.h
Go to the documentation of this file.
1 /* +---------------------------------------------------------------------------+
2  | Mobile Robot Programming Toolkit (MRPT) |
3  | http://www.mrpt.org/ |
4  | |
5  | Copyright (c) 2005-2016, Individual contributors, see AUTHORS file |
6  | See: http://www.mrpt.org/Authors - All rights reserved. |
7  | Released under BSD License. See details in http://www.mrpt.org/License |
8  +---------------------------------------------------------------------------+ */
9 
10 #pragma once
11 
13 #include <mrpt_bridge/laser_scan.h>
15 #include <mrpt_msgs/NodeIDWithLaserScan.h>
16 
17 namespace mrpt { namespace graphslam { namespace deciders {
18 
25 template<class GRAPH_T>
27  public virtual CLoopCloserERD<GRAPH_T>,
28  public virtual CEdgeRegistrationDecider_MR<GRAPH_T>
29 {
30 public:
38  typedef typename lc_parent_t::pose_t pose_t;
43  typedef typename GRAPH_T::global_pose_t global_pose_t;
47 
48  // member implementations
49  bool updateState(
50  mrpt::obs::CActionCollection::Ptr action,
51  mrpt::obs::CSensoryFrame::Ptr observations,
52  mrpt::obs::CObservation::Ptr observation );
54  const std::map<
55  TNodeID,
56  mrpt::obs::CObservation2DRangeScan::Ptr>& nodeIDs_to_scans2D);
57  void addScanMatchingEdges(TNodeID curr_nodeID);
59  const TNodeID& curr_nodeID,
60  std::set<TNodeID>* nodes_set);
61 
62 protected:
63 
64 };
65 
66 } } } // end of namespaces
67 
68 #include "CLoopCloserERD_MR_impl.h"
lc_parent_t::nodes_to_scans2D_t nodes_to_scans2D_t
bool updateState(mrpt::obs::CActionCollection::Ptr action, mrpt::obs::CSensoryFrame::Ptr observations, mrpt::obs::CObservation::Ptr observation)
CEdgeRegistrationDecider_MR< GRAPH_T > mr_parent_t
uint64_t TNodeID
std::vector< mrpt::vector_uint > partitions_t
void addBatchOfNodeIDsAndScans(const std::map< TNodeID, mrpt::obs::CObservation2DRangeScan::Ptr > &nodeIDs_to_scans2D)
void fetchNodeIDsForScanMatching(const TNodeID &curr_nodeID, std::set< TNodeID > *nodes_set)
mrpt::graphslam::CGraphSlamEngine_MR< GRAPH_T > engine_t
mrpt::graphslam::CGraphSlamEngine derived class for executing multi-robot graphSLAM ...
GRAPH_T::constraint_t::type_value pose_t
CLoopCloserERD< GRAPH_T > lc_parent_t
Handy typedefs.


mrpt_graphslam_2d
Author(s): Nikos Koukis
autogenerated on Sat May 2 2020 03:44:17