Main MRPT website > C++ reference for MRPT 1.4.0
maps/CMultiMetricMapPDF.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#ifndef CMultiMetricMapPDF_H
10#define CMultiMetricMapPDF_H
11
16
18
21#include <mrpt/slam/CICP.h>
22
24
26
27namespace mrpt
28{
29namespace slam { class CMetricMapBuilderRBPF; }
30namespace maps
31{
33
34 /** Auxiliary class used in mrpt::maps::CMultiMetricMapPDF
35 * \ingroup mrpt_slam_grp
36 */
37 class SLAM_IMPEXP CRBPFParticleData : public mrpt::utils::CSerializable
38 {
39 // This must be added to any CSerializable derived class:
41 public:
42 CRBPFParticleData( const TSetOfMetricMapInitializers *mapsInitializers = NULL ) :
43 mapTillNow( mapsInitializers ),
44 robotPath()
45 {
46 }
47
49 std::deque<mrpt::math::TPose3D> robotPath;
50 };
52
53
55
56 /** Declares a class that represents a Rao-Blackwellized set of particles for solving the SLAM problem (This class is the base of RBPF-SLAM applications).
57 * This class is used internally by the map building algorithm in "mrpt::slam::CMetricMapBuilderRBPF"
58 *
59 * \sa mrpt::slam::CMetricMapBuilderRBPF
60 * \ingroup metric_slam_grp
61 */
63 public mrpt::utils::CSerializable,
64 public mrpt::bayes::CParticleFilterData<CRBPFParticleData>,
65 public mrpt::bayes::CParticleFilterDataImpl<CMultiMetricMapPDF,mrpt::bayes::CParticleFilterData<CRBPFParticleData>::CParticleList>,
66 public mrpt::slam::PF_implementation<CRBPFParticleData,CMultiMetricMapPDF>
67 {
69
70 // This must be added to any CSerializable derived class:
72
73 protected:
74 /** The PF algorithm implementation.
75 */
77 const mrpt::obs::CActionCollection * action,
78 const mrpt::obs::CSensoryFrame * observation,
80
81 /** The PF algorithm implementation.
82 */
84 const mrpt::obs::CActionCollection * action,
85 const mrpt::obs::CSensoryFrame * observation,
87
88 /** The PF algorithm implementation.
89 */
91 const mrpt::obs::CActionCollection * action,
92 const mrpt::obs::CSensoryFrame * observation,
94
95
96 private:
97 /** Internal buffer for the averaged map. */
100
101 /** The SFs and their corresponding pose estimations:
102 */
104
105 /** A mapping between indexes in the SFs to indexes in the robot paths from particles.
106 */
107 std::vector<uint32_t> SF2robotPath;
108
109
110 /** Entropy aux. function
111 */
112 float H(float p);
113
114 public:
115
116 /** The struct for passing extra simulation parameters to the prediction/update stage
117 * when running a particle filter.
118 * \sa prediction_and_update
119 */
121 {
122 /** Default settings method */
124
125 void loadFromConfigFile(const mrpt::utils::CConfigFileBase &source,const std::string &section) MRPT_OVERRIDE; // See base docs
126 void dumpToTextStream(mrpt::utils::CStream &out) const MRPT_OVERRIDE; // See base docs
127
128 /** [pf optimal proposal only] Only for PF algorithm=2 (Exact "pfOptimalProposal")
129 * Select the map on which to calculate the optimal
130 * proposal distribution. Values:
131 * 0: Gridmap -> Uses Scan matching-based approximation (based on Stachniss' work)
132 * 1: Landmarks -> Uses matching to approximate optimal
133 * 2: Beacons -> Used for exact optimal proposal in RO-SLAM
134 * 3: Pointsmap -> Uses Scan matching-based approximation with a map of points (based on Stachniss' work)
135 * Default = 0
136 */
138
139
140 /** [prediction stage][pf optimal proposal only] If useICPGlobalAlign_withGrid=true, this is the minimum quality ratio [0,1] of the alignment such as it will be accepted. Otherwise, raw odometry is used for those bad cases (default=0.7).
141 */
143
144 /** [update stage] If the likelihood is computed through the occupancy grid map, then this structure is passed to the map when updating the particles weights in the update stage.
145 */
147
149
150 mrpt::slam::CICP::TConfigParams icp_params; //!< ICP parameters, used only when "PF_algorithm=2" in the particle filter.
151
152 } options;
153
154 /** Constructor
155 */
158 const mrpt::maps::TSetOfMetricMapInitializers *mapsInitializers = NULL,
159 const TPredictionParams *predictionOptions = NULL );
160
161 /** Destructor
162 */
164
165 /** Clear all elements of the maps, and restore all paths to a single starting pose */
166 void clear( const mrpt::poses::CPose2D &initialPose );
167
168 /** Clear all elements of the maps, and restore all paths to a single starting pose */
169 void clear( const mrpt::poses::CPose3D &initialPose );
170
171 /** Returns the estimate of the robot pose as a particles PDF for the instant of time "timeStep", from 0 to N-1.
172 * \sa getEstimatedPosePDF
173 */
175 size_t timeStep,
176 mrpt::poses::CPose3DPDFParticles &out_estimation ) const;
177
178 /** Returns the current estimate of the robot pose, as a particles PDF.
179 * \sa getEstimatedPosePDFAtTime
180 */
182
183 /** Returns the weighted averaged map based on the current best estimation. If you need a persistent copy of this object, please use "CSerializable::duplicate" and use the copy.
184 */
186
187 /** Returns a pointer to the current most likely map (associated to the most likely particle).
188 */
190
191 /** Get the number of CSensoryFrame inserted into the internal member SFs */
192 size_t getNumberOfObservationsInSimplemap() const { return SFs.size(); }
193
194 /** Insert an observation to the map, at each particle's pose and to each particle's metric map.
195 * \param sf The SF to be inserted
196 */
198
199 /** Return the path (in absolute coordinate poses) for the i'th particle.
200 * \exception On index out of bounds
201 */
202 void getPath(size_t i, std::deque<math::TPose3D> &out_path) const;
203
204 /** Returns the current entropy of paths, computed as the average entropy of poses along the path, where entropy of each pose estimation is computed as the entropy of the gaussian approximation covariance.
205 */
207
208 /** Returns the joint entropy estimation over paths and maps, acording to "Information Gain-based Exploration Using" by C. Stachniss, G. Grissetti and W.Burgard.
209 */
211
212 /** Update the poses estimation of the member "SFs" according to the current path belief.
213 */
215
216 /** A logging utility: saves the current path estimation for each particle in a text file (a row per particle, each 3-column-entry is a set [x,y,phi], respectively).
217 */
218 void saveCurrentPathEstimationToTextFile( const std::string &fil );
219
220 /** An index [0,1] measuring how much information an observation aports to the map (Typ. threshold=0.07)
221 */
223
224 private:
225 /** Rebuild the "expected" grid map. Used internally, do not call
226 */
228
229
230
231 public:
232 /** \name Virtual methods that the PF_implementations assume exist.
233 @{ */
234
235 /** Return a pointer to the last robot pose in the i'th particle (or NULL if it's a path and it's empty). */
236 const mrpt::math::TPose3D * getLastPose(const size_t i) const;
237
239 CParticleDataContent *particleData,
240 const mrpt::math::TPose3D &newPose) const;
241
242 // The base implementation is fine for this class.
243 // void PF_SLAM_implementation_replaceByNewParticleSet( ...
244
246 const CParticleList &particles,
247 const mrpt::obs::CSensoryFrame *sf) const;
248
250
251 /** Evaluate the observation likelihood for one particle at a given location */
254 const size_t particleIndexForMap,
255 const mrpt::obs::CSensoryFrame &observation,
256 const mrpt::poses::CPose3D &x ) const;
257 /** @} */
258
259
260 }; // End of class def.
262
263 } // End of namespace
264} // End of namespace
265
266#endif
#define DEFINE_SERIALIZABLE_POST_CUSTOM_BASE_LINKAGE(class_name, base_name, _LINKAGE_)
#define DEFINE_SERIALIZABLE(class_name)
This declaration must be inserted in all CSerializable classes definition, within the class declarati...
#define DEFINE_SERIALIZABLE_PRE_CUSTOM_BASE_LINKAGE(class_name, base_name, _LINKAGE_)
This declaration must be inserted in all CSerializable classes definition, before the class declarati...
std::deque< CParticleData > CParticleList
Use this type to refer to the list of particles m_particles.
CRBPFParticleData CParticleDataContent
This is the type inside the corresponding CParticleData class.
This class stores any customizable set of metric maps.
Declares a class that represents a Rao-Blackwellized set of particles for solving the SLAM problem (T...
double PF_SLAM_computeObservationLikelihoodForParticle(const mrpt::bayes::CParticleFilter::TParticleFilterOptions &PF_options, const size_t particleIndexForMap, const mrpt::obs::CSensoryFrame &observation, const mrpt::poses::CPose3D &x) const
Evaluate the observation likelihood for one particle at a given location.
void rebuildAverageMap()
Rebuild the "expected" grid map.
void prediction_and_update_pfStandardProposal(const mrpt::obs::CActionCollection *action, const mrpt::obs::CSensoryFrame *observation, const bayes::CParticleFilter::TParticleFilterOptions &PF_options)
The PF algorithm implementation.
CMultiMetricMap * getCurrentMostLikelyMetricMap()
Returns a pointer to the current most likely map (associated to the most likely particle).
void prediction_and_update_pfAuxiliaryPFOptimal(const mrpt::obs::CActionCollection *action, const mrpt::obs::CSensoryFrame *observation, const bayes::CParticleFilter::TParticleFilterOptions &PF_options)
The PF algorithm implementation.
CMultiMetricMap * getCurrentMetricMapEstimation()
Returns the weighted averaged map based on the current best estimation.
CMultiMetricMapPDF(const bayes::CParticleFilter::TParticleFilterOptions &opts=bayes::CParticleFilter::TParticleFilterOptions(), const mrpt::maps::TSetOfMetricMapInitializers *mapsInitializers=NULL, const TPredictionParams *predictionOptions=NULL)
Constructor.
void getPath(size_t i, std::deque< math::TPose3D > &out_path) const
Return the path (in absolute coordinate poses) for the i'th particle.
void getEstimatedPosePDFAtTime(size_t timeStep, mrpt::poses::CPose3DPDFParticles &out_estimation) const
Returns the estimate of the robot pose as a particles PDF for the instant of time "timeStep",...
double getCurrentEntropyOfPaths()
Returns the current entropy of paths, computed as the average entropy of poses along the path,...
mrpt::maps::CSimpleMap SFs
The SFs and their corresponding pose estimations:
const mrpt::math::TPose3D * getLastPose(const size_t i) const
Return a pointer to the last robot pose in the i'th particle (or NULL if it's a path and it's empty).
mrpt::maps::CMultiMetricMap averageMap
Internal buffer for the averaged map.
void prediction_and_update_pfOptimalProposal(const mrpt::obs::CActionCollection *action, const mrpt::obs::CSensoryFrame *observation, const bayes::CParticleFilter::TParticleFilterOptions &PF_options)
The PF algorithm implementation.
void clear(const mrpt::poses::CPose3D &initialPose)
Clear all elements of the maps, and restore all paths to a single starting pose.
float H(float p)
Entropy aux.
double getCurrentJointEntropy()
Returns the joint entropy estimation over paths and maps, acording to "Information Gain-based Explora...
void clear(const mrpt::poses::CPose2D &initialPose)
Clear all elements of the maps, and restore all paths to a single starting pose.
void PF_SLAM_implementation_custom_update_particle_with_new_pose(CParticleDataContent *particleData, const mrpt::math::TPose3D &newPose) const
virtual ~CMultiMetricMapPDF()
Destructor.
bool PF_SLAM_implementation_doWeHaveValidObservations(const CParticleList &particles, const mrpt::obs::CSensoryFrame *sf) const
float newInfoIndex
An index [0,1] measuring how much information an observation aports to the map (Typ.
void updateSensoryFrameSequence()
Update the poses estimation of the member "SFs" according to the current path belief.
void getEstimatedPosePDF(mrpt::poses::CPose3DPDFParticles &out_estimation) const
Returns the current estimate of the robot pose, as a particles PDF.
void insertObservation(mrpt::obs::CSensoryFrame &sf)
Insert an observation to the map, at each particle's pose and to each particle's metric map.
bool PF_SLAM_implementation_skipRobotMovement() const
Make a specialization if needed, eg.
void saveCurrentPathEstimationToTextFile(const std::string &fil)
A logging utility: saves the current path estimation for each particle in a text file (a row per part...
std::vector< uint32_t > SF2robotPath
A mapping between indexes in the SFs to indexes in the robot paths from particles.
size_t getNumberOfObservationsInSimplemap() const
Get the number of CSensoryFrame inserted into the internal member SFs.
With this struct options are provided to the observation likelihood computation process.
Auxiliary class used in mrpt::maps::CMultiMetricMapPDF.
CRBPFParticleData(const TSetOfMetricMapInitializers *mapsInitializers=NULL)
std::deque< mrpt::math::TPose3D > robotPath
This class stores a sequence of <Probabilistic Pose,SensoryFrame> pairs, thus a "metric map" can be t...
size_t size() const
Returns the count of pairs (pose,sensory data)
A set of TMetricMapInitializer structures, passed to the constructor CMultiMetricMap::CMultiMetricMap...
Declares a class for storing a collection of robot actions.
Declares a class for storing a "sensory frame", a set of "observations" taken by the robot approximat...
A class used to store a 2D pose.
Definition: CPose2D.h:37
A class used to store a 3D pose (a 3D translation + a rotation in 3D).
Definition: CPose3D.h:73
Declares a class that represents a Probability Density function (PDF) of a 3D pose.
The ICP algorithm configuration data.
Definition: CICP.h:58
This class implements a Rao-Blackwelized Particle Filter (RBPF) approach to map building (SLAM).
Option set for KLD algorithm.
Definition: TKLDParams.h:23
This class allows loading and storing values and vectors of different types from a configuration text...
This is a virtual base class for sets of options than can be loaded from and/or saved to configuratio...
This base class is used to provide a unified interface to files,memory buffers,..Please see the deriv...
Definition: CStream.h:39
#define MRPT_OVERRIDE
C++11 "override" for virtuals:
Definition: mrpt_macros.h:28
This is the global namespace for all Mobile Robot Programming Toolkit (MRPT) libraries.
The configuration of a particle filter.
The struct for passing extra simulation parameters to the prediction/update stage when running a part...
void dumpToTextStream(mrpt::utils::CStream &out) const MRPT_OVERRIDE
This method should clearly display all the contents of the structure in textual form,...
float ICPGlobalAlign_MinQuality
[prediction stage][pf optimal proposal only] If useICPGlobalAlign_withGrid=true, this is the minimum ...
COccupancyGridMap2D::TLikelihoodOptions update_gridMapLikelihoodOptions
[update stage] If the likelihood is computed through the occupancy grid map, then this structure is p...
int pfOptimalProposal_mapSelection
[pf optimal proposal only] Only for PF algorithm=2 (Exact "pfOptimalProposal") Select the map on whic...
mrpt::slam::CICP::TConfigParams icp_params
ICP parameters, used only when "PF_algorithm=2" in the particle filter.
void loadFromConfigFile(const mrpt::utils::CConfigFileBase &source, const std::string &section) MRPT_OVERRIDE
This method load the options from a ".ini"-like file or memory-stored string list.
Lightweight 3D pose (three spatial coordinates, plus three angular coordinates).



Page generated by Doxygen 1.9.6 for MRPT 1.4.0 SVN: at Fri Jan 20 00:13:14 UTC 2023