Namespaces | |
apps | |
deciders | |
detail | |
optimizers | |
Classes | |
class | CGraphSlamEngine |
class | CGraphSlamEngine_MR |
mrpt::graphslam::CGraphSlamEngine derived class for executing multi-robot graphSLAM More... | |
class | CGraphSlamEngine_ROS |
Class template that provides a wrapper around the MRPT CGraphSlamEngine class template and implements methods for interacting with ROS. More... | |
class | CMapMerger |
Class responsible of the execution of the map_merger_node. More... | |
class | CRegistrationDeciderOrOptimizer |
class | CRegistrationDeciderOrOptimizer_MR |
Interface for implementing deciders/optimizers related to the Condensed Measurements multi-robot graphSLAM algorithm. More... | |
class | CRegistrationDeciderOrOptimizer_ROS |
Interface class that all ROS-specific deciders/optimizers can inherit from. More... | |
class | CWindowManager |
class | CWindowObserver |
struct | graphslam_traits |
struct | TNeighborAgentMapProps |
Struct holding a COccupancyGridMap2D (as well as subscribers for updating it) for a specific running GraphSlamAgent instance. More... | |
struct | TResultInfoSpaLevMarq |
struct | TSlidingWindow |
struct | TUncertaintyPath |
Functions | |
double | computeJacobiansAndErrors (const GRAPH_T &graph, const std::vector< typename graphslam_traits< GRAPH_T >::observation_info_t > &lstObservationData, typename graphslam_traits< GRAPH_T >::map_pairIDs_pairJacobs_t &lstJacobians, typename mrpt::aligned_containers< typename graphslam_traits< GRAPH_T >::Array_O >::vector_t &errs) |
void | optimize_graph_spa_levmarq (GRAPH_T &graph, TResultInfoSpaLevMarq &out_info, const std::set< mrpt::utils::TNodeID > *in_nodes_to_optimize=NULL, const mrpt::utils::TParametersDouble &extra_params=mrpt::utils::TParametersDouble(), typename graphslam_traits< GRAPH_T >::TFunctorFeedback functor_feedback=NULL) |