MRPT  2.0.2
Namespaces | Macros | Functions
exceptions.h File Reference
#include <mrpt/core/common.h>
#include <mrpt/core/format.h>
#include <stdexcept>
#include <string>
#include <string_view>
Include dependency graph for exceptions.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 mrpt::internal
 
 mrpt
 This is the global namespace for all Mobile Robot Programming Toolkit (MRPT) libraries.
 

Macros

#define THROW_TYPED_EXCEPTION(msg, exceptionClass)
 
#define THROW_EXCEPTION(msg)   THROW_TYPED_EXCEPTION(msg, std::logic_error)
 
#define THROW_EXCEPTION_FMT(_FORMAT_STRING, ...)   THROW_EXCEPTION(mrpt::format(_FORMAT_STRING, __VA_ARGS__))
 
#define THROW_TYPED_EXCEPTION_FMT(exceptionClass, _FORMAT_STRING, ...)
 
#define THROW_STACKED_EXCEPTION
 
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG2(stuff, param1)
 
#define MRPT_THROW_UNKNOWN_SERIALIZATION_VERSION(__V)
 For use in CSerializable implementations. More...
 
#define ASSERTMSG_(f, __ERROR_MSG)
 Defines an assertion mechanism. More...
 
#define ASSERT_(f)   ASSERTMSG_(f, std::string("Assert condition failed: ") + ::std::string(#f))
 Defines an assertion mechanism. More...
 
#define MRPT_CHECK_NORMAL_NUMBER(v)
 Throws an exception if the number is NaN, IND, or +/-INF, or return the same number otherwise. More...
 
#define ASRT_FAIL(__CONDITIONSTR, __A, __B, __ASTR, __BSTR)
 
#define ASSERT_EQUAL_(__A, __B)
 Assert comparing two values, reporting their actual values upon failure. More...
 
#define ASSERT_NOT_EQUAL_(__A, __B)
 
#define ASSERT_BELOW_(__A, __B)
 
#define ASSERT_ABOVE_(__A, __B)
 
#define ASSERT_BELOWEQ_(__A, __B)
 
#define ASSERT_ABOVEEQ_(__A, __B)
 
#define ASSERTDEB_(f)   while (0){}
 Defines an assertion mechanism - only when compiled in debug. More...
 
#define ASSERTDEBMSG_(f, __ERROR_MSG)   while (0){}
 
#define ASSERTDEB_EQUAL_(__A, __B)   while (0){}
 
#define ASSERTDEB_NOT_EQUAL_(__A, __B)   while (0){}
 
#define ASSERTDEB_BELOW_(__A, __B)   while (0){}
 
#define ASSERTDEB_ABOVE_(__A, __B)   while (0){}
 
#define ASSERTDEB_BELOWEQ_(__A, __B)   while (0){}
 
#define ASSERTDEB_ABOVEEQ_(__A, __B)   while (0){}
 
#define MRPT_TRY_START
 The start of a standard MRPT "try...catch()" block that allows tracing throw the call stack after an exception. More...
 
#define MRPT_TRY_END
 The end of a standard MRPT "try...catch()" block that allows tracing throw the call stack after an exception. More...
 
#define MRPT_TRY_END_WITH_CLEAN_UP(stuff)
 The end of a standard MRPT "try...catch()" block that allows tracing throw the call stack after an exception, including a "clean up" piece of code to be run before throwing the exceptions. More...
 
#define MRPT_PROFILE_FUNC_START
 
#define MRPT_START
 
#define MRPT_END   MRPT_TRY_END
 
#define MRPT_END_WITH_CLEAN_UP(stuff)   MRPT_TRY_END_WITH_CLEAN_UP(stuff)
 

Functions

std::string mrpt::internal::exception_line_msg (const std::string_view &msg, const char *filename, unsigned int line, const char *function_name)
 
template<typename A , typename B >
std::string mrpt::internal::asrt_fail (std::string s, A &&a, B &&b, const char *astr, const char *bstr)
 
std::string mrpt::exception_to_str (const std::exception &e)
 Builds a nice textual representation of a nested exception, which if generated using MRPT macros (THROW_EXCEPTION,...) in between MRPT_START/MRPT_END macros, will contain function names and line numbers across the call stack at the original throw point. More...
 

Macro Definition Documentation

◆ ASRT_FAIL

#define ASRT_FAIL (   __CONDITIONSTR,
  __A,
  __B,
  __ASTR,
  __BSTR 
)
Value:
mrpt::internal::asrt_fail(__CONDITIONSTR, __A, __B, __ASTR, __BSTR));
#define THROW_EXCEPTION(msg)
Definition: exceptions.h:67
std::string asrt_fail(std::string s, A &&a, B &&b, const char *astr, const char *bstr)
Definition: exceptions.h:25

Definition at line 132 of file exceptions.h.

◆ ASSERT_

#define ASSERT_ (   f)    ASSERTMSG_(f, std::string("Assert condition failed: ") + ::std::string(#f))

Defines an assertion mechanism.

Note
Do NOT put code that must be always executed inside this statement, but just comparisons. This is because users might require ASSERT_'s to be ignored for optimized releases.
See also
MRPT_TRY_START, MRPT_TRY_END

Definition at line 120 of file exceptions.h.

Referenced by mrpt::math::CHistogram::add(), mrpt::vision::add_3d_deltas_to_points(), mrpt::math::CSparseMatrix::add_AB(), mrpt::slam::CIncrementalMapPartitioner::addMapFrame(), mrpt::opengl::CMeshFast::adjustGridToImageAR(), mrpt::opengl::CMesh::adjustGridToImageAR(), mrpt::opengl::CVectorField2D::adjustVectorFieldToGrid(), mrpt::img::TColorManager::advanceRGBCounters(), mrpt::slam::CGridMapAligner::AlignPDF_correlation(), mrpt::slam::CGridMapAligner::AlignPDF_robustMatch(), mrpt::opengl::COpenGLBuffer::RAII_Impl::allocate(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::appendCol(), mrpt::poses::CPose3DPDFSOG::appendFrom(), mrpt::opengl::CSetOfLines::appendLineStrip(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::appendRow(), mrpt::opengl::TRenderMatrices::applyLookAt(), mrpt::hmtslam::CHMTSLAM::areaAbstraction(), mrpt::opengl::COctoMapVoxels::areVoxelsVisible(), mrpt::opengl::CMeshFast::assignImageAndZ(), mrpt::opengl::CMesh::assignImageAndZ(), mrpt::math::averageLogLikelihood(), mrpt::vision::ba_compute_Jacobians(), mrpt::math::CSparseMatrix::CholeskyDecomp::backsub(), mrpt::poses::CPose3DPDFSOG::bayesianFusion(), mrpt::poses::CPosePDFGaussian::bayesianFusion(), mrpt::poses::CPosePDFGaussianInf::bayesianFusion(), mrpt::poses::CPointPDFSOG::bayesianFusion(), mrpt::poses::CPosePDFSOG::bayesianFusion(), mrpt::opengl::COpenGLVertexArrayObject::RAII_Impl::bind(), mrpt::opengl::COpenGLBuffer::RAII_Impl::bind(), mrpt::nav::CAbstractPTGBasedReactive::build_movement_candidate(), mrpt::nav::CAbstractPTGBasedReactive::calc_move_candidate_scores(), calc_trans_distance_t_below_Tramp_abc_numeric(), mrpt::math::CConstMatrixColumnAccessor< MAT >::CConstMatrixColumnAccessor(), mrpt::math::CConstMatrixColumnAccessorExtended< MAT >::CConstMatrixColumnAccessorExtended(), mrpt::math::CConstMatrixRowAccessor< MAT >::CConstMatrixRowAccessor(), mrpt::math::CConstMatrixRowAccessorExtended< MAT >::CConstMatrixRowAccessorExtended(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::CDijkstra(), mrpt::opengl::CFBORender::CFBORender(), mrpt::system::CFileSystemWatcher::CFileSystemWatcher(), mrpt::hmtslam::CLocalMetricHypothesis::changeCoordinateOrigin(), mrpt::img::CMappedImage::changeCoordinates(), mrpt::nav::CReactiveNavigationSystem::changeRobotCircularShapeRadius(), mrpt::nav::CReactiveNavigationSystem::checkCollisionWithLatestObstacles(), mrpt::nav::CReactiveNavigationSystem3D::checkCollisionWithLatestObstacles(), mrpt::hwdrivers::CEnoseModular::checkConnectionAndConnect(), mrpt::hwdrivers::CBoardENoses::checkConnectionAndConnect(), mrpt::vision::checkerBoardStereoCalibration(), mrpt::math::chi2inv(), mrpt::math::CHistogram::CHistogram(), mrpt::math::CSparseMatrix::CholeskyDecomp::CholeskyDecomp(), mrpt::hwdrivers::CImageGrabber_dc1394::CImageGrabber_dc1394(), mrpt::maps::CMultiMetricMapPDF::clear(), mrpt::comms::CInterfaceFTDI::Close(), mrpt::math::CMatrixColumnAccessor< MAT >::CMatrixColumnAccessor(), mrpt::math::CMatrixColumnAccessorExtended< MAT >::CMatrixColumnAccessorExtended(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::CMatrixDynamic(), mrpt::math::CMatrixRowAccessor< MAT >::CMatrixRowAccessor(), mrpt::math::CMatrixRowAccessorExtended< MAT >::CMatrixRowAccessorExtended(), mrpt::kinematics::CVehicleVelCmd_DiffDriven::cmdVel_limits(), mrpt::io::CMemoryStream::CMemoryStream(), mrpt::maps::CColouredPointsMap::colourFromObservation(), mrpt::io::zip::compress(), mrpt::maps::CMultiMetricMap::compute3DMatchingRatio(), mrpt::system::compute_CRC16(), mrpt::system::compute_CRC32(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeCoordinatesTransformationBetweenNodes(), mrpt::obs::CActionRobotMovement2D::computeFromOdometry_modelGaussian(), mrpt::obs::CActionRobotMovement2D::computeFromOdometry_modelThrun(), mrpt::maps::CLandmarksMap::computeLikelihood_RSLC_2007(), mrpt::maps::CLandmarksMap::computeLikelihood_SIFT_LandmarkMap(), mrpt::maps::CLandmarksMap::computeMatchingWith2D(), mrpt::maps::CLandmarksMap::computeMatchingWith3DLandmarks(), mrpt::maps::COccupancyGridMap2D::computeObservationLikelihood_ConsensusOWA(), mrpt::slam::CRangeBearingKFSLAM::computeOffDiagonalBlocksApproximationError(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeOverlapProbabilityBetweenNodes(), mrpt::nav::PlannerSimple2D::computePath(), mrpt::bayes::CParticleFilterCapable::computeResampling(), mrpt::vision::computeSAD(), mrpt::vision::computeStereoRectificationMaps(), mrpt::hmtslam::CTopLCDetector_GridMatching::computeTopologicalObservationModel(), mrpt::math::confidenceIntervals(), mrpt::ros1bridge::convert(), mrpt::poses::CPose3DPDFParticles::copyFrom(), mrpt::poses::CPosePDFParticles::copyFrom(), mrpt::poses::CPose3DPDFGaussianInf::copyFrom(), mrpt::poses::CPose3DPDF::createFrom2D(), mrpt::math::CHistogram::createWithFixedWidth(), mrpt::math::cross_correlation_FFT(), mrpt::img::CImage::cross_correlation_FFT(), mrpt::math::crossProduct3D(), mrpt::math::CSparseMatrix::cs2dense(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::data(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::data(), mrpt::slam::data_association_full_covariance(), mrpt::slam::data_association_independent_predictions(), mrpt::nav::ClearanceDiagram::decimated_k_to_real_k(), mrpt::opengl::Program::declareAttribute(), mrpt::opengl::Program::declareUniform(), mrpt::io::zip::decompress(), mrpt::rtti::TRuntimeClassId::derivedFrom(), mrpt::vision::CFeature::descriptorBLDDistanceTo(), mrpt::vision::CFeature::descriptorLATCHDistanceTo(), mrpt::vision::CFeature::descriptorLogPolarImgDistanceTo(), mrpt::vision::CFeature::descriptorORBDistanceTo(), mrpt::vision::CFeature::descriptorPolarImgDistanceTo(), mrpt::vision::CFeature::descriptorSIFTDistanceTo(), mrpt::vision::CFeature::descriptorSpinImgDistanceTo(), mrpt::vision::CFeature::descriptorSURFDistanceTo(), mrpt::maps::CBeaconMap::determineMatching2D(), mrpt::maps::CPointsMap::determineMatching2D(), mrpt::maps::COccupancyGridMap2D::determineMatching2D(), mrpt::maps::CPointsMap::determineMatching3D(), mrpt::math::dft2_complex(), mrpt::apps::MonteCarloLocalization_Base::do_pf_localization(), mrpt::poses::CPoseRandomSampler::do_sample_2D(), mrpt::poses::CPoseRandomSampler::do_sample_3D(), mrpt::hwdrivers::CIMUIntersense::doProcess(), mrpt::hwdrivers::CGPSInterface::doProcess(), mrpt::slam::CMetricMapBuilderRBPF::drawCurrentEstimationToImage(), mrpt::img::CEnhancedMetaFile::drawImage(), mrpt::img::CCanvas::drawImage(), mrpt::poses::CPoint2DPDFGaussian::drawSingleSample(), mrpt::poses::CPointPDFGaussian::drawSingleSample(), mrpt::poses::CPointPDFSOG::drawSingleSample(), mrpt::hmtslam::CHierarchicalMapMHPartition::dumpAsText(), mrpt::opengl::Program::dumpProgramDescription(), mrpt::tfest::TMatchingPairList::dumpToFile(), mrpt::obs::gnss::Message_TOPCON_SATS::dumpToStream(), mrpt::obs::CActionCollection::erase(), mrpt::obs::CSensoryFrame::erase(), mrpt::obs::CSensoryFrame::eraseByIndex(), mrpt::math::estimateJacobian(), mrpt::expr::CRuntimeCompiledExpression::eval(), mrpt::nav::CHolonomicFullEval::evalSingleTarget(), mrpt::nav::CHolonomicND::evaluateGaps(), mrpt::poses::CPointPDFSOG::evaluatePDFInArea(), mrpt::poses::CPosePDFSOG::evaluatePDFInArea(), mrpt::obs::CObservation2DRangeScanWithUncertainty::evaluateScanLikelihood(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::exactBisection(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::system::extractDayTimeFromTimestamp(), mrpt::vision::CFeatureExtraction::extractFeaturesSIFT(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::extractSubGraph(), mrpt::maps::internal::TMetricMapTypesRegistry::factoryMapDefinition(), mrpt::maps::internal::TMetricMapTypesRegistry::factoryMapObjectFromDefinition(), mrpt::maps::CPointCloudFilterByDistance::filter(), mrpt::vision::find_descriptor_pairings(), mrpt::vision::findChessboardCorners(), mrpt::vision::findMultipleChessboardsCorners(), mrpt::obs::CRawlog::findObservationsByClassInRange(), mrpt::hmtslam::CHierarchicalMapMHPartition::findPathBetweenNodes(), mrpt::vision::frameJac(), mrpt::math::CQuaternion< T >::fromRodriguesVector(), mrpt::comms::CInterfaceFTDI::ftdi_getQueueStatus(), mrpt::comms::CInterfaceFTDI::ftdi_listDevices(), mrpt::comms::CInterfaceFTDI::ftdi_open(), mrpt::comms::CInterfaceFTDI::ftdi_openEx(), mrpt::comms::CInterfaceFTDI::ftdi_read(), mrpt::comms::CInterfaceFTDI::ftdi_write(), func_laserSimul_callback(), mrpt::maps::CPointsMap::fuseWith(), mrpt::nav::CHolonomicND::gapsEstimator(), mrpt::hmtslam::CHMTSLAM::generateLogFiles(), mrpt::vision::generateMask(), mrpt::maps::CBeacon::generateObservationModelDistribution(), mrpt::opengl::CAngularObservationMesh::generatePointCloud(), mrpt::maps::CBeacon::generateRingSOG(), mrpt::math::ModelSearch::geneticSingleModel(), mrpt::maps::CBeaconMap::get(), mrpt::poses::CPointPDFSOG::get(), mrpt::poses::CPosePDFSOG::get(), mrpt::expr::CRuntimeCompiledExpression::get_raw_exprtk_expr(), get_words(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::graphs::detail::TNodeAnnotations::getAnnotsAsString(), mrpt::hmtslam::CMHPropertiesValuesList::getAs(), mrpt::kinematics::CKinematicChain::getAs3DObject(), mrpt::maps::CPointsMapXYZI::getAs3DObject(), mrpt::maps::CColouredPointsMap::getAs3DObject(), mrpt::maps::CRandomFieldGridMap2D::getAs3DObject(), mrpt::hmtslam::CLocalMetricHypothesis::getAs3DScene(), mrpt::slam::CIncrementalMapPartitioner::getAs3DScene(), mrpt::img::CImage::getAsIplImage(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::maps::CRandomFieldGridMap2D::getAsMatrix(), mrpt::img::CImage::getAsMatrix(), mrpt::img::CImage::getAsRGBMatrices(), mrpt::maps::CMultiMetricMap::getAsSimplePointsMap(), mrpt::poses::CPoseInterpolatorBase< 3 >::getBoundingBox(), mrpt::poses::CPose2DGridTemplate< double >::getByIndex(), mrpt::poses::CPose3DGridTemplate< double >::getByIndex(), mrpt::serialization::CMessage::getContentAsStruct(), mrpt::poses::CPose3DPDFParticles::getCovarianceAndMean(), mrpt::maps::CMultiMetricMapPDF::getCurrentJointEntropy(), mrpt::slam::CMetricMapBuilderICP::getCurrentMapPoints(), mrpt::hmtslam::CLocalMetricHypothesis::getCurrentPose(), mrpt::slam::CRangeBearingKFSLAM2D::getCurrentRobotPose(), mrpt::slam::CRangeBearingKFSLAM::getCurrentRobotPose(), mrpt::slam::CRangeBearingKFSLAM2D::getCurrentState(), mrpt::slam::CRangeBearingKFSLAM::getCurrentState(), mrpt::obs::CObservationGasSensors::getDescriptionAsText(), mrpt::graphs::detail::THypothesis< GRAPH_T >::getEdge(), mrpt::maps::CMultiMetricMapPDF::getEstimatedPosePDF(), mrpt::img::CImage::getExternalStorageFileAbsolutePath(), mrpt::graphs::detail::THypothesis< GRAPH_T >::getInverseEdge(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::getLandmarkMean(), mrpt::opengl::CSetOfLines::getLineByIndex(), mrpt::vision::CFeatureList::getMaxID(), mrpt::vision::CMatchedFeatureList::getMaxID(), mrpt::poses::CPointPDFParticles::getMean(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getMostLikelyParticle(), mrpt::obs::CObservationGPS::getMsgByClass(), mrpt::nav::TMoveTree< NODE_TYPE_DATA, EDGE_TYPE, MAPS_IMPLEMENTATION >::getNearestNode(), mrpt::hwdrivers::CCameraSensor::getNextFrame(), mrpt::io::CTextFileLinesParser::getNextLine(), mrpt::hwdrivers::CSwissRanger3DCamera::getNextObservation(), mrpt::hmtslam::CHMHMapArc::getNodeFrom(), mrpt::hmtslam::CHMHMapArc::getNodeTo(), mrpt::hwdrivers::CMyntEyeCamera::getObservation(), mrpt::hwdrivers::CBoardSonars::getObservation(), mrpt::hwdrivers::CEnoseModular::getObservation(), mrpt::hwdrivers::CBoardENoses::getObservation(), mrpt::poses::CPoseRandomSampler::getOriginalPDFCov2D(), mrpt::poses::CPoseRandomSampler::getOriginalPDFCov3D(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::getPathDist(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::getPathPose(), mrpt::nav::CPTG_Holo_Blend::getPathStepCount(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::getPathStepCount(), mrpt::nav::CPTG_Holo_Blend::getPathStepForDist(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::getPathStepForDist(), mrpt::hmtslam::CLocalMetricHypothesis::getPoseParticles(), mrpt::nav::CReactiveNavigationSystem::getPTG(), mrpt::nav::CReactiveNavigationSystem3D::getPTG(), mrpt::nav::CReactiveNavigationSystem3D::getPTG_count(), mrpt::math::CBinaryRelation< T, U, UIsObject >::getRelationFrom(), mrpt::math::CBinaryRelation< T, U, UIsObject >::getRelationTo(), mrpt::hmtslam::CLocalMetricHypothesis::getRelativePose(), mrpt::poses::CPoseRandomSampler::getSamplingMean2D(), mrpt::poses::CPoseRandomSampler::getSamplingMean3D(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::getShortestPathTo(), mrpt::obs::CSinCosLookUpTableFor2DScans::getSinCosForScan(), mrpt::hwdrivers::CStereoGrabber_SVS::getStereoObservation(), mrpt::nav::CAbstractPTGBasedReactive::getTargetApproachSlowDownDistance(), mrpt::system::getTempFileName(), mrpt::opengl::CAxis::getTextLabelOrientation(), mrpt::maps::CLandmark::getType(), mrpt::math::CPolygon::GetVertex_x(), mrpt::math::CPolygon::GetVertex_y(), mrpt::opengl::COctoMapVoxels::getVoxelCount(), mrpt::maps::CGasConcentrationGridMap2D::getWindAs3DObject(), mrpt::obs::CObservation3DRangeScan::getZoneAsObs(), mrpt::math::homogeneousMatrixInverse(), mrpt::slam::CICP::ICP3D_Method_Classic(), mrpt::slam::CICP::ICP_Method_Classic(), mrpt::slam::CICP::ICP_Method_LM(), mrpt::math::idft2_complex(), mrpt::math::idft2_real(), mrpt::poses::CPose2DGridTemplate< double >::idx2phi(), mrpt::poses::CPose3DGridTemplate< double >::idx2pitch(), mrpt::poses::CPose3DGridTemplate< double >::idx2roll(), mrpt::poses::CPose2DGridTemplate< double >::idx2x(), mrpt::poses::CPose3DGridTemplate< double >::idx2x(), mrpt::poses::CPose2DGridTemplate< double >::idx2y(), mrpt::poses::CPose3DGridTemplate< double >::idx2y(), mrpt::poses::CPose3DGridTemplate< double >::idx2yaw(), mrpt::poses::CPose3DGridTemplate< double >::idx2z(), mrpt::nav::CAbstractPTGBasedReactive::impl_waypoint_is_reachable(), mrpt::nav::CNavigatorManualSequence::initialize(), mrpt::hwdrivers::CIMUXSens_MT4::initialize(), mrpt::nav::CAbstractPTGBasedReactive::initialize(), mrpt::opengl::CRenderizableShaderTexturedTriangles::initializeTextures(), mrpt::maps::CSimpleMap::insert(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_GMRF(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KernelDM_DMV(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KF(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KF2(), mrpt::maps::CRandomFieldGridMap2D::internal_clear(), mrpt::vision::CFeatureExtraction::internal_computeLogPolarImageDescriptors(), mrpt::vision::CFeatureExtraction::internal_computePolarImageDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeSiftDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeSpinImageDescriptors(), mrpt::img::CImage::internal_fromIPL(), mrpt::nav::CPTG_Holo_Blend::internal_initialize(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::internal_initialize(), mrpt::maps::CRandomFieldGridMap3D::internal_initialize(), mrpt::maps::CBeaconMap::internal_insertObservation(), mrpt::maps::CGasConcentrationGridMap2D::internal_insertObservation(), mrpt::maps::COccupancyGridMap2D::internal_insertObservation(), mrpt::maps::CPointsMap::internal_insertObservation(), mrpt::nav::PlannerTPS_VirtualBase::internal_loadConfig_PTG(), mrpt::obs::VelodyneCalibration::internal_loadFromXMLNode(), mrpt::hwdrivers::CVelodyneScanner::internal_read_PCAP_packet(), mrpt::serialization::CArchive::internal_ReadObjectHeader(), mrpt::math::interpolate(), mrpt::poses::CPose3DPDFParticles::inverse(), mrpt::poses::CPose3DQuatPDFGaussianInf::inverse(), mrpt::poses::CPose3DQuatPDFGaussian::inverse(), mrpt::poses::CPose3DPDFSOG::inverse(), mrpt::poses::CPose3DPDFGaussianInf::inverse(), mrpt::poses::CPosePDFParticles::inverse(), mrpt::poses::CPosePDFGaussian::inverse(), mrpt::poses::CPose3DPDFGaussian::inverse(), mrpt::poses::CPosePDFGaussianInf::inverse(), mrpt::poses::CPosePDFSOG::inverse(), mrpt::nav::CPTG_Holo_Blend::inverseMap_WS2TP(), mrpt::expr::CRuntimeCompiledExpression::is_compiled(), mrpt::img::CImage::joinImagesHorz(), mrpt::slam::joint_pdf_metric(), mrpt::math::KLD_Gaussians(), mrpt::slam::KLF_loadBinFromParticle(), mrpt::maps::COccupancyGridMap2D::laserScanSimulator(), mrpt::math::leastSquareLinearFit(), mrpt::opengl::Program::linkProgram(), mrpt::hwdrivers::CSickLaserSerial::LMS_endContinuousMode(), mrpt::hwdrivers::CSickLaserSerial::LMS_sendMeasuringMode_cm_mm(), mrpt::hwdrivers::CSickLaserSerial::LMS_setupBaudrate(), mrpt::hwdrivers::CSickLaserSerial::LMS_setupSerialComms(), mrpt::hwdrivers::CSickLaserSerial::LMS_startContinuousMode(), mrpt::hwdrivers::CSickLaserSerial::LMS_statusQuery(), mrpt::hwdrivers::CSickLaserSerial::LMS_waitACK(), mrpt::hwdrivers::CSickLaserSerial::LMS_waitIncomingFrame(), mrpt::maps::CGasConcentrationGridMap2D::load_Gaussian_Wind_Grid_From_File(), mrpt::hwdrivers::C2DRangeFinderAbstract::loadCommonParams(), mrpt::hwdrivers::CBoardENoses::loadConfig_sensorSpecific(), mrpt::hwdrivers::CBoardSonars::loadConfig_sensorSpecific(), mrpt::nav::CReactiveNavigationSystem::loadConfigFile(), mrpt::nav::CReactiveNavigationSystem3D::loadConfigFile(), mrpt::nav::CAbstractPTGBasedReactive::loadConfigFile(), mrpt::opengl::COpenGLViewport::loadDefaultShaders(), mrpt::nav::CHolonomicND::TOptions::loadFromConfigFile(), mrpt::bayes::CParticleFilter::TParticleFilterOptions::loadFromConfigFile(), mrpt::nav::CHolonomicFullEval::TOptions::loadFromConfigFile(), mrpt::slam::CRangeBearingKFSLAM2D::TOptions::loadFromConfigFile(), mrpt::slam::CRangeBearingKFSLAM::TOptions::loadFromConfigFile(), mrpt::maps::TSetOfMetricMapInitializers::loadFromConfigFile(), mrpt::hmtslam::CHMTSLAM::TOptions::loadFromConfigFile(), mrpt::opengl::CPointCloud::loadFromPointsMap(), mrpt::poses::CPoseInterpolatorBase< 3 >::loadFromTextFile(), mrpt::obs::CObservation2DRangeScan::loadFromVectors(), mrpt::obs::VelodyneCalibration::loadFromYAMLText(), mrpt::ros1bridge::MapHdl::loadMap(), mrpt::hmtslam::CHMTSLAM::loadOptions(), mrpt::bayes::CParticleFilterCapable::log2linearWeights(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_AA(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_TBI(), mrpt::math::mahalanobisDistance2(), mrpt::img::TColorManager::markColorAsUsed(), mrpt::vision::matchFeatures(), mrpt::math::MATLAB_plotCovariance2D(), mrpt::math::maximum(), mrpt::system::md5(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::poses::CPosePDFSOG::mergeModes(), mrpt::math::minimum(), mrpt::math::minimum_maximum(), mrpt::math::CSparseMatrix::multiply_AB(), myGeneralDFT(), mrpt::gui::CDisplayWindowGUI::nanogui_win(), mrpt::nav::CHolonomicVFF::navigate(), mrpt::nav::CHolonomicND::navigate(), mrpt::nav::CHolonomicFullEval::navigate(), mrpt::nav::CWaypointsNavigator::navigateWaypoints(), mrpt::math::ncc_vector(), mrpt::math::normalCDF(), mrpt::vision::normalizeImage(), mrpt::math::normalQuantile(), mrpt::slam::CRangeBearingKFSLAM2D::OnNewLandmarkAddedToMap(), mrpt::slam::CRangeBearingKFSLAM::OnNewLandmarkAddedToMap(), mrpt::hmtslam::CHierarchicalMHMap::onNodeAddition(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionNoise(), mrpt::slam::CRangeBearingKFSLAM::OnTransitionNoise(), mrpt::vision::openCV_cross_correlation(), mrpt::slam::detail::TPathBin2D::lt_operator::operator()(), mrpt::img::CImage::operator()(), mrpt::safe_ptr< mrpt::hmtslam::CHierarchicalMHMap >::operator*(), mrpt::non_copiable_ptr< T >::operator*(), mrpt::copiable_NULL_ptr< T >::operator*(), mrpt::safe_ptr_basic< mrpt::hmtslam::CHierarchicalMHMap >::operator->(), mrpt::obs::gnss::gnss_message_ptr::operator->(), mrpt::non_copiable_ptr_basic< void >::operator->(), mrpt::ignored_copy_ptr< mrpt::maps::COctoMapBase >::operator->(), mrpt::copiable_NULL_ptr_basic< T >::operator->(), mrpt::math::TPoint2D_< double >::operator/(), mrpt::math::TPoint2D_< double >::operator/=(), mrpt::maps::CBeaconMap::operator[](), mrpt::poses::CPointPDFSOG::operator[](), mrpt::poses::CPosePDFSOG::operator[](), mrpt::safe_ptr< mrpt::hmtslam::CHierarchicalMHMap >::operator[](), mrpt::non_copiable_ptr< T >::operator[](), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::operator[](), mrpt::copiable_NULL_ptr< T >::operator[](), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator[](), mrpt::hwdrivers::CHokuyoURG::parseResponse(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::particlesEvaluator_AuxPFOptimal(), mrpt::vision::CFeature::patchCorrelationTo(), mrpt::topography::path_from_rtk_gps(), mrpt::hmtslam::CHMTSLAM::perform_TLC(), mrpt::nav::CAbstractPTGBasedReactive::performNavigationStep(), mrpt::nav::CAbstractNavigator::performNavigationStepNavigating(), mrpt::bayes::CParticleFilterCapable::performResampling(), mrpt::slam::CMonteCarloLocalization3D::PF_SLAM_computeObservationLikelihoodForParticle(), mrpt::slam::CMonteCarloLocalization2D::PF_SLAM_computeObservationLikelihoodForParticle(), mrpt::maps::CMultiMetricMapPDF::PF_SLAM_implementation_doWeHaveValidObservations(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_gatherActionsCheckBothActObs(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfStandardProposal(), mrpt::slam::CMonteCarloLocalization3D::PF_SLAM_implementation_replaceByNewParticleSet(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_replaceByNewParticleSet(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::poses::CPose2DGridTemplate< double >::phi2idx(), mrpt::math::ModelSearch::pickRandomIndex(), mrpt::poses::CPose3DGridTemplate< double >::pitch2idx(), mrpt::vision::pixelTo3D(), mrpt::gui::CDisplayWindow::plot(), mrpt::gui::CDisplayWindowPlots::plotEllipse(), mrpt::vision::pointJac(), mrpt::obs::CObservation3DRangeScan::points3D_convertToExternalStorage(), mrpt::obs::CObservation3DRangeScan::points3D_getExternalStorageFileAbsolutePath(), mrpt::opengl::CSetOfObjects::posePDF2opengl(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::hmtslam::CLocalMetricHypothesis::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfOptimalProposal(), mrpt::hmtslam::CLocalMetricHypothesis::prediction_and_update_pfOptimalProposal(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::prediction_and_update_pfOptimalProposal(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfStandardProposal(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfStandardProposal(), mrpt::bayes::CParticleFilterCapable::prepareFastDrawSample(), mrpt::obs::CActionRobotMovement2D::prepareFastDrawSingleSample_modelGaussian(), mrpt::detectors::CDetectorDoorCrossing::process(), mrpt::slam::CRangeBearingKFSLAM2D::processActionObservation(), mrpt::slam::CRangeBearingKFSLAM::processActionObservation(), mrpt::slam::CMetricMapBuilderRBPF::processActionObservation(), mrpt::nav::CAbstractNavigator::processNavigateCommand(), mrpt::slam::CMetricMapBuilderICP::processObservation(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::processOneLMH(), mrpt::hwdrivers::CSkeletonTracker::processPreview(), mrpt::hwdrivers::CSkeletonTracker::processPreviewNone(), mrpt::opengl::processRenderQueue(), mrpt::math::productIntegralAndMahalanobisTwoGaussians(), mrpt::math::productIntegralTwoGaussians(), mrpt::opengl::Program::programId(), mrpt::vision::projectMatchedFeature(), mrpt::vision::projectMatchedFeatures(), mrpt::vision::pinhole::projectPoint_no_distortion(), mrpt::vision::pinhole::projectPoints_with_distortion(), mrpt::comms::CInterfaceFTDI::Purge(), mrpt::maps::CLandmarksMap::TCustomSequenceLandmarks::push_back(), mrpt::hwdrivers::CCANBusReader::queryVersion(), mrpt::obs::CObservation3DRangeScan::rangeImage_convertToExternalStorage(), mrpt::obs::CObservation3DRangeScan::rangeImage_getAsImage(), mrpt::obs::CObservation3DRangeScan::rangeImage_getExternalStorageFileAbsolutePath(), mrpt::math::ransac2Dline_distance(), mrpt::math::ransac2Dline_fit(), mrpt::math::ransac3Dplane_distance(), mrpt::math::ransac3Dplane_fit(), ransac_data_assoc_run(), mrpt::math::ransac_detect_2D_lines(), mrpt::math::ModelSearch::ransacSingleModel(), mrpt::serialization::CArchive::ReadBuffer(), mrpt::hwdrivers::readConfigIntoVideoSourcePanel(), mrpt::serialization::CArchive::ReadObject(), mrpt::comms::CSerialPort::ReadString(), mrpt::nav::ClearanceDiagram::real_k_to_decimated_k(), mrpt::maps::CMultiMetricMapPDF::rebuildAverageMap(), mrpt::hmtslam::CLocalMetricHypothesis::rebuildMetricMaps(), mrpt::obs::CObservation3DRangeScan::recoverCameraCalibrationParameters(), mrpt::vision::CStereoRectifyMap::rectify(), mrpt::bayes::CRejectionSamplingCapable< CPose2D >::rejectionSampling(), mrpt::hmtslam::CLocalMetricHypothesis::removeAreaFromLMH(), mrpt::math::CBinaryRelation< T, U, UIsObject >::removeElementAt(), mrpt::opengl::COpenGLScene::removeObject(), mrpt::slam::CIncrementalMapPartitioner::removeSetOfNodes(), mrpt::nav::ClearanceDiagram::renderAs3DObject(), mrpt::nav::PlannerTPS_VirtualBase::renderMoveTree(), mrpt::opengl::COpenGLViewport::renderNormalSceneMode(), mrpt::opengl::COctoMapVoxels::reserveVoxels(), mrpt::poses::CPosePDFParticles::resetAroundSetOfPoses(), mrpt::comms::CInterfaceFTDI::ResetDevice(), mrpt::slam::CMonteCarloLocalization2D::resetUniformFreeSpace(), mrpt::io::CMemoryStream::resize(), mrpt::maps::CRandomFieldGridMap2D::resize(), mrpt::opengl::COctoMapVoxels::resizeVoxels(), mrpt::poses::CPose3DGridTemplate< double >::roll2idx(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::RS_drawFromProposal(), mrpt::apps::CGridMapAlignerApp::run(), mrpt::apps::ICP_SLAM_App_Base::run(), mrpt::apps::RBPF_SLAM_App_Base::run(), mrpt::apps::KFSLAMApp::Run_KF_SLAM(), run_test_pf_localization(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::maps::CRandomFieldGridMap2D::saveAsMatlab3DGraph(), mrpt::obs::CObservationStereoImagesFeatures::saveFeaturesToTextFile(), mrpt::maps::CMultiMetricMap::saveMetricMapRepresentationToFile(), mrpt::img::CImage::saveToFile(), mrpt::img::CImage::saveToStreamAsJPEG(), mrpt::maps::CBeaconMap::saveToTextFile(), mrpt::maps::CLandmarksMap::saveToTextFile(), mrpt::math::CSparseMatrix::saveToTextFile_sparse(), mrpt::img::TCamera::scaleToResolution(), se2_l2_impl(), mrpt::tfest::se2_l2_robust(), mrpt::hwdrivers::CHokuyoURG::sendCmd(), mrpt::hwdrivers::CCANBusReader::sendCommandToCANReader(), mrpt::hwdrivers::CSickLaserSerial::SendCommandToSICK(), mrpt::obs::CObservationGasSensors::serializeFrom(), mrpt::maps::CGasConcentrationGridMap2D::serializeFrom(), mrpt::maps::CWirelessPowerGridMap2D::serializeFrom(), mrpt::maps::COccupancyGridMap3D::serializeFrom(), mrpt::maps::COccupancyGridMap2D::serializeFrom(), mrpt::maps::CHeightGridMap2D::serializeFrom(), mrpt::poses::CPose3D::serializeFrom(), mrpt::obs::CObservationIMU::serializeFrom(), mrpt::obs::CObservation3DRangeScan::serializeFrom(), mrpt::obs::CSensoryFrame::serializeTo(), mrpt::maps::COccupancyGridMap2D::serializeTo(), mrpt::img::CImage::serializeTo(), mrpt::obs::CObservation3DRangeScan::serializeTo(), mrpt::Clock::setActiveClock(), mrpt::io::CMemoryStream::setAllocBlockSize(), mrpt::maps::CPointsMap::setAllPointsTemplate(), mrpt::math::CPolygon::setAllVertices(), mrpt::math::CSparseMatrix::setColCount(), mrpt::comms::CSerialPort::setConfig(), mrpt::img::TCamera::setDistortionParamsVector(), mrpt::opengl::CAxis::setFrequency(), mrpt::vision::CStereoRectifyMap::setFromCamParams(), mrpt::img::CImage::setFromRGBMatrices(), mrpt::opengl::CGridPlaneXZ::setGridFrequency(), mrpt::opengl::CGridPlaneXY::setGridFrequency(), mrpt::nav::CAbstractPTGBasedReactive::setHolonomicMethod(), mrpt::hwdrivers::CGPSInterface::setJAVAD_AIM_mode(), mrpt::comms::CInterfaceFTDI::SetLatencyTimer(), mrpt::maps::CMultiMetricMap::setListOfMaps(), mrpt::poses::CPoseInterpolatorBase< 3 >::setMaxTimeInterpolation(), mrpt::maps::CRandomFieldGridMap2D::setMeanAndSTD(), mrpt::gui::CDisplayWindowPlots::setMenuCallback(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::setParams(), mrpt::img::CImage::setPixel(), mrpt::maps::CPointsMapXYZI::setPointAllFieldsFast(), mrpt::opengl::CVectorField3D::setPointCoordinates(), mrpt::math::CSparseMatrix::setRowCount(), mrpt::poses::CPose2DGridTemplate< double >::setSize(), mrpt::math::CVectorDynamic< KFTYPE >::setSize(), mrpt::maps::COccupancyGridMap2D::setSize(), mrpt::opengl::CAxis::setTextLabelOrientation(), mrpt::opengl::CAxis::setTextScale(), mrpt::comms::CInterfaceFTDI::SetTimeouts(), mrpt::hwdrivers::CServoeNeck::setTruncateFactor(), mrpt::hwdrivers::CCANBusReader::setupSerialComms(), mrpt::opengl::CVectorField2D::setVectorField(), mrpt::opengl::CVectorField3D::setVectorField(), mrpt::opengl::COpenGLViewport::setViewportPosition(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::opengl::COctoMapVoxels::showVoxels(), mrpt::maps::CGasConcentrationGridMap2D::simulateAdvection(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::simulateTrajectories(), mrpt::math::skew_symmetric3(), mrpt::math::skew_symmetric3_neg(), mrpt::maps::COccupancyGridMap2D::sonarSimulator(), mrpt::math::spline(), mrpt::maps::CPointsMap::squareDistanceToClosestCorrespondence(), mrpt::nav::CReactiveNavigationSystem3D::STEP3_WSpaceToTPSpace(), mrpt::math::detail::stub_kmeans(), mrpt::maps::COccupancyGridMap2D::subSample(), mrpt::hmtslam::CHMTSLAM::TBI_main_method(), TEST(), GraphTester< my_graph_t >::test_optimize_compare_known_solution(), mrpt::hmtslam::CHMTSLAM::thread_LSLAM(), mrpt::system::timeDifference(), mrpt::system::timestampToParts(), mrpt::vision::CFeatureTracker_KL::trackFeatures_impl_templ(), mrpt::math::CSparseMatrix::transpose(), mrpt::obs::CObservation2DRangeScan::truncateByDistanceAndAngle(), mrpt::hwdrivers::CSickLaserSerial::tryToOpenComms(), mrpt::vision::TSIFTDescriptorsKDTreeIndex< distance_t, metric_t >::TSIFTDescriptorsKDTreeIndex(), mrpt::vision::TSURFDescriptorsKDTreeIndex< distance_t, metric_t >::TSURFDescriptorsKDTreeIndex(), mrpt::vision::pinhole::undistort_points(), mrpt::obs::CObservationPointCloud::unload(), mrpt::obs::detail::unprojectInto(), mrpt::hmtslam::CLocalMetricHypothesis::updateAreaFromLMH(), mrpt::maps::COccupancyGridMap3D::updateCell(), mrpt::nav::CParameterizedTrajectoryGenerator::updateClearance(), mrpt::graphs::ScalarFactorGraph::updateEstimation(), mrpt::maps::CRandomFieldGridMap3D::updateMapEstimation(), mrpt::maps::CRandomFieldGridMap2D::updateMapEstimation_GMRF(), mrpt::nav::CParameterizedTrajectoryGenerator::updateNavDynamicState(), mrpt::opengl::CMeshFast::updatePoints(), mrpt::opengl::CMesh::updateTriangles(), mrpt::topography::UTMToGeodetic(), mrpt::nav::CWaypointsNavigator::waypoints_navigationStep(), mrpt::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), mrpt::io::CMemoryStream::Write(), mrpt::hwdrivers::CNationalInstrumentsDAQ::writeAnalogOutputTask(), mrpt::serialization::CArchive::WriteBuffer(), mrpt::hwdrivers::writeConfigFromVideoSourcePanel(), mrpt::hwdrivers::CNationalInstrumentsDAQ::writeDigitalOutputTask(), mrpt::poses::CPose2DGridTemplate< double >::x2idx(), mrpt::poses::CPose3DGridTemplate< double >::x2idx(), mrpt::poses::CPose2DGridTemplate< double >::y2idx(), mrpt::poses::CPose3DGridTemplate< double >::y2idx(), mrpt::poses::CPose3DGridTemplate< double >::yaw2idx(), and mrpt::poses::CPose3DGridTemplate< double >::z2idx().

◆ ASSERT_ABOVE_

#define ASSERT_ABOVE_ (   __A,
  __B 
)
Value:
do \
{ \
if (__A <= __B) ASRT_FAIL("ASSERT_ABOVE_", __A, __B, #__A, #__B) \
} while (0)
#define ASRT_FAIL(__CONDITIONSTR, __A, __B, __ASTR, __BSTR)
Definition: exceptions.h:132

Definition at line 155 of file exceptions.h.

Referenced by buildPyramid_templ(), mrpt::nav::collision_free_dist_arc_circ_robot(), mrpt::nav::collision_free_dist_segment_circ_robot(), mrpt::opengl::TRenderMatrices::computeOrthoProjectionMatrix(), mrpt::opengl::TRenderMatrices::computeProjectionMatrix(), mrpt::obs::CObservation3DRangeScan::convertTo2DScan(), mrpt::vision::CFeature::descriptorPolarImgDistanceTo(), mrpt::maps::CPointsMap::determineMatching2D(), mrpt::maps::COccupancyGridMap2D::determineMatching2D(), mrpt::maps::CPointsMap::determineMatching3D(), mrpt::nav::CHolonomicFullEval::evalSingleTarget(), mrpt::math::RANSAC_Template< NUMTYPE, DATASET, MODEL >::execute(), mrpt::obs::CObservationRotatingScan::fromVelodyne(), mrpt::nav::CParameterizedTrajectoryGenerator::getPathTwist(), mrpt::math::TPlane::getUnitaryNormalVector(), mrpt::hwdrivers::CNationalInstrumentsDAQ::initialize(), mrpt::maps::CRandomFieldGridMap3D::insertIndividualReading(), mrpt::maps::CLandmarksMap::internal_computeObservationLikelihood(), mrpt::obs::VelodyneCalibration::internal_loadFromXMLNode(), mrpt::opengl::CArrow::onUpdateBuffers_Triangles(), mrpt::opengl::CCylinder::onUpdateBuffers_Triangles(), mrpt::opengl::CDisk::onUpdateBuffers_Triangles(), mrpt::opengl::CGridPlaneXY::onUpdateBuffers_Wireframe(), mrpt::obs::CObservation3DRangeScan::rangeImage_getAsImage(), mrpt::obs::CObservation3DRangeScan::rangeImageAsImage(), mrpt::nav::PlannerTPS_VirtualBase::renderMoveTree(), mrpt::kinematics::CVehicleSimul_Holo::sendVelRampCmd(), mrpt::apps::RawlogGrabberApp::SensorThread(), mrpt::system::CRateTimer::setRate(), mrpt::maps::COccupancyGridMap3D::setSize(), mrpt::poses::CPose3DGridTemplate< double >::setSize(), mrpt::maps::COccupancyGridMap2D::setSize(), mrpt::opengl::COpenGLViewport::setViewportClipDistances(), mrpt::nav::PlannerRRT_SE2_TPS::solve(), mrpt::math::TPlane::TPlane(), mrpt::math::TPoint3D_< float >::unitarize(), and mrpt::opengl::CMesh::updateTriangles().

◆ ASSERT_ABOVEEQ_

#define ASSERT_ABOVEEQ_ (   __A,
  __B 
)

◆ ASSERT_BELOW_

#define ASSERT_BELOW_ (   __A,
  __B 
)
Value:
do \
{ \
if (__A >= __B) ASRT_FAIL("ASSERT_BELOW_", __A, __B, #__A, #__B) \
} while (0)
#define ASRT_FAIL(__CONDITIONSTR, __A, __B, __ASTR, __BSTR)
Definition: exceptions.h:132

Definition at line 149 of file exceptions.h.

Referenced by mrpt::maps::CPointsMap::determineMatching2D(), mrpt::maps::COccupancyGridMap2D::determineMatching2D(), mrpt::maps::CPointsMap::determineMatching3D(), mrpt::hwdrivers::CHokuyoURG::ensureBufferHasBytes(), mrpt::math::RANSAC_Template< NUMTYPE, DATASET, MODEL >::execute(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::extractColumn(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::extractRow(), mrpt::obs::CObservationRotatingScan::fromVelodyne(), mrpt::poses::CPose3DGridTemplate< double >::getAsMatrix(), mrpt::nav::ClearanceDiagram::getClearance(), mrpt::kinematics::CKinematicChain::getLink(), mrpt::kinematics::CKinematicChain::getLinkRef(), mrpt::obs::CSensoryFrame::getObservationByIndex(), mrpt::maps::CPointsMap::getPoint(), mrpt::maps::CPointsMap::getPointAllFields(), mrpt::obs::CObservation2DRangeScan::getScanIntensity(), mrpt::obs::CObservation2DRangeScan::getScanRange(), mrpt::obs::CObservation2DRangeScan::getScanRangeValidity(), mrpt::opengl::CSetOfTexturedTriangles::getTriangle(), mrpt::opengl::CSetOfTriangles::getTriangle(), mrpt::nav::CParameterizedTrajectoryGenerator::index2alpha(), mrpt::obs::VelodyneCalibration::internal_loadFromXMLNode(), mrpt::obs::gnss::Message_NV_OEM6_RANGECMP::internal_readFromStream(), mrpt::obs::gnss::Message_NV_OEM6_VERSION::internal_readFromStream(), mrpt::poses::CPose3D::inverseComposePoint(), mrpt::nav::CPTG_DiffDrive_C::inverseMap_WS2TP(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::inverseMap_WS2TP(), mrpt::opengl::CPointCloud::operator[](), mrpt::math::CBinaryRelation< T, U, UIsObject >::operator[](), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator[](), mrpt::opengl::CPointCloudColoured::recolorizeByCoordinate(), mrpt::kinematics::CKinematicChain::removeLink(), mrpt::apps::KFSLAMApp::Run_KF_SLAM(), mrpt::opengl::CPointCloudColoured::setPoint(), mrpt::maps::CPointsMap::setPoint(), mrpt::maps::CPointsMap::setPointAllFields(), mrpt::obs::CObservation2DRangeScan::setScanIntensity(), mrpt::obs::CObservation2DRangeScan::setScanRange(), mrpt::obs::CObservation2DRangeScan::setScanRangeValidity(), mrpt::nav::CReactiveNavigationSystem::STEP3_WSpaceToTPSpace(), and velodyne_scan_to_pointcloud().

◆ ASSERT_BELOWEQ_

#define ASSERT_BELOWEQ_ (   __A,
  __B 
)

◆ ASSERT_EQUAL_

#define ASSERT_EQUAL_ (   __A,
  __B 
)
Value:
do \
{ \
if (__A != __B) ASRT_FAIL("ASSERT_EQUAL_", __A, __B, #__A, #__B) \
} while (0)
#define ASRT_FAIL(__CONDITIONSTR, __A, __B, __ASTR, __BSTR)
Definition: exceptions.h:132

Assert comparing two values, reporting their actual values upon failure.

Definition at line 137 of file exceptions.h.

Referenced by mrpt::slam::CGridMapAligner::AlignPDF_correlation(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::appendCol(), mrpt::maps::CPointsMap::applyDeletionMask(), mrpt::maps::COccupancyGridMap2D::buildVoronoiDiagram(), mrpt::nav::CAbstractPTGBasedReactive::calc_move_candidate_scores(), mrpt::nav::CReactiveNavigationSystem3D::checkCollisionWithLatestObstacles(), mrpt::vision::checkerBoardStereoCalibration(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::CMatrixFixed(), mrpt::obs::CObservation3DRangeScan::convertTo2DScan(), mrpt::poses::CPose3D::CPose3D(), mrpt::vision::CFeature::descriptorPolarImgDistanceTo(), mrpt::math::deserializeSymmetricMatrixFrom(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::eig(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::eig_symmetric(), mrpt::nav::CHolonomicFullEval::evalSingleTarget(), mrpt::obs::CObservation2DRangeScanWithUncertainty::evaluateScanLikelihood(), mrpt::obs::CObservation2DRangeScan::filterByExclusionAngles(), mrpt::obs::CObservation2DRangeScan::filterByExclusionAreas(), mrpt::maps::COccupancyGridMap2D::findCriticalPoints(), mrpt::poses::CPoint< CPoint3D, 3 >::fromString(), mrpt::math::TTwist3D::fromVector(), mrpt::math::CVectorDynamic< KFTYPE >::fromVectorLike(), mrpt::obs::CObservation3DRangeScan::get_unproj_lut(), mrpt::opengl::CFBORender::getFrame2(), mrpt::hwdrivers::CMyntEyeCamera::getObservation(), mrpt::hwdrivers::CNationalInstrumentsDAQ::grabbing_thread(), mrpt::opengl::CRenderizableShaderTexturedTriangles::initializeTextures(), mrpt::maps::CRandomFieldGridMap3D::internal_initialize(), mrpt::obs::VelodyneCalibration::internal_loadFromXMLNode(), mrpt::gui::CDisplayWindowPlots::internal_plot(), mrpt::obs::gnss::Message_NV_OEM6_RANGECMP::internal_writeToStream(), mrpt::obs::gnss::Message_NV_OEM6_VERSION::internal_writeToStream(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::inverse(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::inverse_LLt(), mrpt::obs::CObservation3DRangeScan::load(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::loadFromArray(), mrpt::nav::CHolonomicFullEval::TOptions::loadFromConfigFile(), mrpt::maps::CPointsMap::loadFromVelodyneScan(), mrpt::obs::VelodyneCalibration::loadFromYAMLText(), mrpt::math::CSparseMatrix::matProductOf_Ab(), mrpt::math::multiply_A_skew3(), mrpt::math::multiply_HCHt_scalar(), mrpt::math::multiply_HtCH_scalar(), mrpt::math::multiply_skew3_A(), mrpt::nav::CHolonomicFullEval::navigate(), mrpt::opengl::CMeshFast::onUpdateBuffers_Points(), mrpt::math::TTwist3D::operator()(), mrpt::math::operator*(), mrpt::math::operator*=(), mrpt::math::operator+(), mrpt::math::operator+=(), mrpt::math::operator-(), mrpt::containers::ContainerReadOnlyProxyAccessor< STLCONTAINER >::operator=(), mrpt::nav::CAbstractPTGBasedReactive::performNavigationStep(), mrpt::slam::CMonteCarloLocalization2D::PF_SLAM_implementation_replaceByNewParticleSet(), mrpt::obs::detail::range2XYZ_LUT(), mrpt::graphs::detail::graph_ops< graph_t >::read_graph_of_poses_from_binary_file(), mrpt::obs::gnss::gnss_message::readFromStream(), mrpt::poses::CPosePDFParticles::resetAroundSetOfPoses(), mrpt::math::internal::ProvideStaticResize< TPose3DQuat >::resize(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::resize(), mrpt::nav::CHolonomicND::TOptions::saveToConfigFile(), mrpt::nav::CHolonomicFullEval::TOptions::saveToConfigFile(), mrpt::maps::CPointsMapXYZI::saveToKittiVelodyneFile(), se3_l2_internal(), mrpt::hwdrivers::CHokuyoURG::sendCmd(), mrpt::poses::CPose3DPDFGrid::serializeFrom(), mrpt::maps::CGasConcentrationGridMap2D::serializeFrom(), mrpt::maps::CWirelessPowerGridMap2D::serializeFrom(), mrpt::maps::CHeightGridMap2D_MRF::serializeFrom(), mrpt::maps::CRandomFieldGridMap3D::serializeFrom(), mrpt::img::CImage::serializeFrom(), mrpt::math::serializeSymmetricMatrixTo(), mrpt::obs::CObservation2DRangeScan::serializeTo(), mrpt::obs::CObservationRotatingScan::serializeTo(), mrpt::maps::CPointsMap::setAllPointsTemplate(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::setCol(), mrpt::kinematics::CKinematicChain::setConfiguration(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::setCovMatrixAndMean(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::setDiagonal(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::setIdentity(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::setRow(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::setSize(), mrpt::math::CSplineInterpolator1D::setXY(), mrpt::nav::CReactiveNavigationSystem3D::STEP3_WSpaceToTPSpace(), TEST(), mrpt::opengl::TTriangle::TTriangle(), mrpt::obs::detail::unprojectInto(), and mrpt::opengl::CMeshFast::updateColorsMatrix().

◆ ASSERT_NOT_EQUAL_

#define ASSERT_NOT_EQUAL_ (   __A,
  __B 
)
Value:
do \
{ \
if (__A == __B) ASRT_FAIL("ASSERT_NOT_EQUAL_", __A, __B, #__A, #__B) \
} while (0)
#define ASRT_FAIL(__CONDITIONSTR, __A, __B, __ASTR, __BSTR)
Definition: exceptions.h:132

Definition at line 143 of file exceptions.h.

Referenced by mrpt::ros1bridge::fromROS(), mrpt::maps::detail::pointmap_traits< CColouredPointsMap >::internal_loadFromRangeScan2D_init(), and mrpt::maps::detail::pointmap_traits< CColouredPointsMap >::internal_loadFromRangeScan3D_init().

◆ ASSERTDEB_

#define ASSERTDEB_ (   f)    while (0){}

Defines an assertion mechanism - only when compiled in debug.

Note
Do NOT put code that must be always executed inside this statement, but just comparisons. This is because users might require ASSERT_'s to be ignored for optimized releases.
See also
MRPT_TRY_START, MRPT_TRY_END

Definition at line 190 of file exceptions.h.

Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::bayes::detail::addNewLandmarks(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::alignOpticalWithMRPTFrame(), mrpt::vision::ba_compute_Jacobians(), CGraphSlamHandler< GRAPH_T >::CGraphSlamHandler(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::checkPartitionsForLC(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::math::covariancesAndMeanWeighted(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evalPWConsistenciesMatrix(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::execDijkstraProjection(), CGraphSlamHandler< GRAPH_T >::execute(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::fetchNodeIDsForScanMatching(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::fillNodePropsFromGroupParams(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::findPathByEnds(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistencyElement(), mrpt::opengl::COpenGLViewport::get3DRayForPixelCoord(), mrpt::maps::CHeightGridMap2D::getAs3DObject(), mrpt::graphslam::detail::TNodeProps< GRAPH_T >::getAsString(), mrpt::slam::CRangeBearingKFSLAM::getCurrentRobotPoseMean(), mrpt::opengl::COctoMapVoxels::getGridCube(), mrpt::opengl::COctoMapVoxels::getGridCubeRef(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getICPEdge(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getMinUncertaintyPath(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getNodeIDsOfEstimatedTrajectory(), CGraphSlamHandler< GRAPH_T >::getParamsAsString(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getParamsAsString(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getPropsOfNodeID(), mrpt::graphslam::detail::CEdgeCounter::getTotalNumOfEdges(), mrpt::opengl::COctoMapVoxels::getVoxel(), mrpt::opengl::COctoMapVoxels::getVoxelRef(), mrpt::math::homogeneousMatrixInverse(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initClass(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initCurrPosViewport(), CGraphSlamHandler< GRAPH_T >::initEngine(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initEstimatedTrajectoryVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initGTVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::initializeVisuals(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initIntensityImageViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initOdometryVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initRangeImageViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initSlamMetricVisualization(), mrpt::vision::CFeatureListKDTree< FEAT >::kdtree_distance(), mrpt::vision::CFeatureList::kdtree_distance(), mrpt::vision::CFeatureListKDTree< FEAT >::kdtree_get_pt(), mrpt::vision::CFeatureList::kdtree_get_pt(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::KF_aux_estimate_obs_Hx_jacobian(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::KF_aux_estimate_obs_Hy_jacobian(), mrpt::math::mahalanobisDistance2(), mrpt::math::mahalanobisDistance2AndLogPDF(), markAsPicked(), mrpt::math::normalPDF(), mrpt::math::normalPDFInf(), mrpt::graphslam::CRegistrationDeciderOrOptimizer< GRAPH_t >::notifyOfWindowEvents(), mrpt::slam::CRangeBearingKFSLAM2D::OnObservationModel(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::operator()(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::operator[](), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::popMinUncertaintyPath(), mrpt::opengl::COctoMapVoxels::push_back_Voxel(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::queryObserverForEvents(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::resetPDF(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), CGraphSlamHandler< GRAPH_T >::saveResults(), se3_l2_internal(), mrpt::maps::CSimplePointsMap::setPointAllFieldsFast(), mrpt::maps::CWeightedPointsMap::setPointAllFieldsFast(), mrpt::maps::CColouredPointsMap::setPointAllFieldsFast(), mrpt::graphslam::detail::CEdgeCounter::setWindowManagerPtr(), mrpt::graphslam::CRegistrationDeciderOrOptimizer< GRAPH_t >::setWindowManagerPtr(), mrpt::math::slerp(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleEstimatedTrajectoryVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleGTVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleMapVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleOdometryVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateCurrPosViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateEstimatedTrajectoryVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateGTVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateIntensityImageViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateMapVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateOdometryVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateRangeImageViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateSlamMetricVisualization(), mrpt::graphslam::detail::CEdgeCounter::updateTextMessages(), mrpt::graphslam::CRegistrationDeciderOrOptimizer< GRAPH_t >::updateVisuals(), mrpt::math::weightedHistogram(), and mrpt::math::weightedHistogramLog().

◆ ASSERTDEB_ABOVE_

#define ASSERTDEB_ABOVE_ (   __A,
  __B 
)    while (0){}

Definition at line 195 of file exceptions.h.

Referenced by mrpt::graphslam::optimize_graph_spa_levmarq().

◆ ASSERTDEB_ABOVEEQ_

#define ASSERTDEB_ABOVEEQ_ (   __A,
  __B 
)    while (0){}

Definition at line 197 of file exceptions.h.

◆ ASSERTDEB_BELOW_

#define ASSERTDEB_BELOW_ (   __A,
  __B 
)    while (0){}

Definition at line 194 of file exceptions.h.

◆ ASSERTDEB_BELOWEQ_

#define ASSERTDEB_BELOWEQ_ (   __A,
  __B 
)    while (0){}

Definition at line 196 of file exceptions.h.

◆ ASSERTDEB_EQUAL_

#define ASSERTDEB_EQUAL_ (   __A,
  __B 
)    while (0){}

◆ ASSERTDEB_NOT_EQUAL_

#define ASSERTDEB_NOT_EQUAL_ (   __A,
  __B 
)    while (0){}

Definition at line 193 of file exceptions.h.

◆ ASSERTDEBMSG_

#define ASSERTDEBMSG_ (   f,
  __ERROR_MSG 
)    while (0){}

Definition at line 191 of file exceptions.h.

Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::graphslam::TUncertaintyPath< GRAPH_T >::assertIsBetweenNodeIDs(), mrpt::graphslam::CRegistrationDeciderOrOptimizer< GRAPH_t >::assertVisualsVars(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkRegistrationDeciderExists(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpRegistrarsToConsole(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::execDijkstraProjection(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::fitGraphInView(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generateHypotsPool(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistenciesMatrix(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::generateReportFiles(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getGraphSlamStats(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::getICPEdge(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getMinUncertaintyPath(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getPropsOfNodeID(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getTimeStamp(), mrpt::graphslam::TUncertaintyPath< GRAPH_T >::hasLowerUncertaintyThan(), CGraphSlamHandler< GRAPH_T >::initEngine(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::initGraphVisualization(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::initializeVisuals(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::initializeVisuals(), CGraphSlamHandler< GRAPH_T >::initOutputDir(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initResultsFile(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::loadFromConfigFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::loadParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::graphslam::TUncertaintyPath< GRAPH_T >::operator+=(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::TRGBDInfoFileParams::parseFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::queryObserverForEvents(), CGraphSlamHandler< GRAPH_T >::readConfigFname(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFileRGBD_TUM(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::registerNewNodeAtEnd(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::save3DScene(), mrpt::graphslam::detail::CEdgeCounter::setTextMessageParams(), mrpt::math::TPose3D::SO3_to_yaw_pitch_roll(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::toggleLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::toggleLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::toggleMapPartitionsVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateGraphVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateOdometryVisualization(), and mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateOptDistanceVisualization().

◆ ASSERTMSG_

#define ASSERTMSG_ (   f,
  __ERROR_MSG 
)
Value:
do \
{ \
if (!(f)) THROW_EXCEPTION(::std::string(__ERROR_MSG)); \
} while (0)
#define THROW_EXCEPTION(msg)
Definition: exceptions.h:67

Defines an assertion mechanism.

Note
Do NOT put code that must be always executed inside this statement, but just comparisons. This is because users might require ASSERT_'s to be ignored for optimized releases.
See also
MRPT_TRY_START, MRPT_TRY_END

Definition at line 108 of file exceptions.h.

Referenced by mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::addVirtualEdge(), mrpt::slam::CGridMapAligner::AlignPDF_robustMatch(), mrpt::obs::CRawlog::asObservation(), mrpt::poses::CPose3DQuat::iterator::check_limits(), mrpt::poses::CPose3DQuat::const_iterator::check_limits(), mrpt::hwdrivers::CRoboPeakLidar::checkCOMMs(), mrpt::kinematics::CVehicleVelCmd_DiffDriven::cmdVel_limits(), mrpt::kinematics::CVehicleVelCmd_Holo::cmdVel_limits(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::connectGraphPartitions(), mrpt::math::MatrixVectorBase< T, CMatrixFixed< T, ROWS, COLS > >::Constant(), mrpt::math::CSparseMatrix::construct_from_existing_cs(), mrpt::math::CSparseMatrix::copy(), mrpt::math::covariancesAndMeanWeighted(), mrpt::math::CQuaternion< T >::CQuaternion(), mrpt::math::CSparseMatrix::CSparseMatrix(), mrpt::math::CVectorDynamic< KFTYPE >::CVectorDynamic(), mrpt::rtti::TRuntimeClassId::derivedFrom(), mrpt::maps::CMultiMetricMap::determineMatching2D(), mrpt::maps::CPointsMap::determineMatching2D(), mrpt::maps::CPointsMap::determineMatching3D(), do_rectify(), mrpt::math::MatrixVectorBase< T, CMatrixFixed< T, ROWS, COLS > >::dot(), mrpt::graphs::detail::CVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >::drawEdgeRelPoses(), mrpt::graphs::detail::CVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >::drawEdges(), mrpt::graphs::detail::CMRVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >::drawEdges(), mrpt::graphs::detail::CVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >::drawGroundGrid(), mrpt::graphs::detail::CVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >::drawNodeCorners(), mrpt::graphs::detail::CVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >::drawNodePoints(), mrpt::graphs::detail::CMRVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >::drawNodePoints(), mrpt::config::CConfigFilePrefixer::ensureIsBound(), mrpt::system::extractDayTimeFromTimestamp(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::extractSubGraph(), mrpt::vision::find_descriptor_pairings(), mrpt::hmtslam::CHierarchicalMapMHPartition::findPathBetweenNodes(), mrpt::math::CQuaternion< T >::fromRodriguesVector(), mrpt::rtti::CListOfClasses::fromString(), mrpt::math::TTwist2D::fromString(), mrpt::math::TPose3DQuat::fromString(), mrpt::math::TPose2D::fromString(), mrpt::math::TTwist3D::fromString(), mrpt::math::TPoint2D_< double >::fromString(), mrpt::math::TPose3D::fromString(), mrpt::math::TPoint3D_< float >::fromString(), mrpt::poses::CPose3DQuat::fromString(), mrpt::poses::CPose2D::fromString(), mrpt::poses::CPose3D::fromString(), mrpt::obs::CObservationIMU::get(), mrpt::graphs::detail::THypothesis< GRAPH_T >::getAsString(), mrpt::math::TPolygon2D::getBoundingBox(), mrpt::opengl::COpenGLScene::getBoundingBox(), mrpt::system::CFileSystemWatcher::getChanges(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::getEdgeSquareError(), mrpt::obs::CObservationGPS::getMsgByClass(), mrpt::obs::CObservationGPS::getMsgByType(), mrpt::hwdrivers::CVelodyneScanner::getNextObservation(), mrpt::poses::internal::getPoseFromString(), mrpt::hwdrivers::CKinect::getTiltAngleDegrees(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::getTreeGraph(), mrpt::graphs::detail::NotConnectedGraph::getUnconnectedNodeIDs(), mrpt::graphs::detail::graph_ops< graph_t >::graph_edge_sqerror(), mrpt::graphs::detail::graph_ops< graph_t >::graph_of_poses_dijkstra_init(), mrpt::math::MatrixBase< T, CMatrixFixed< T, ROWS, COLS > >::Identity(), mrpt::hwdrivers::CNationalInstrumentsDAQ::initialize(), mrpt::opengl::CSetOfObjects::insert(), mrpt::maps::CRandomFieldGridMap3D::insertIndividualReading(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::internal_initialize(), mrpt::nav::PlannerTPS_VirtualBase::internal_initialize_PTG(), mrpt::maps::CReflectivityGridMap2D::internal_insertObservation(), mrpt::system::CObservable::internal_observer_end(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::internal_processNewRobotShape(), mrpt::hwdrivers::CVelodyneScanner::internal_send_http_post(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::inverseMap_WS2TP(), mrpt::img::CImage::KLT_response(), mrpt::obs::CObservationPointCloud::load(), mrpt::hwdrivers::C2DRangeFinderAbstract::loadCommonParams(), mrpt::hwdrivers::CNTRIPEmitter::loadConfig_sensorSpecific(), mrpt::hwdrivers::CHokuyoURG::loadConfig_sensorSpecific(), mrpt::nav::CNavigatorManualSequence::loadConfigFile(), mrpt::nav::CReactiveNavigationSystem::loadConfigFile(), mrpt::maps::CMetricMap::loadFromProbabilisticPosesAndObservations(), mrpt::img::CImage::loadFromXPM(), mrpt::ros1bridge::MapHdl::loadMap(), mrpt::hwdrivers::TCaptureOptions_FlyCapture2::loadOptionsFrom(), mrpt::nav::CPTG_RobotShape_Polygonal::loadShapeFromConfigFile(), mrpt::poses::FrameTransformer< 2 >::lookupTransform(), mrpt::math::meanAndCovMat(), mrpt::math::meanAndCovVec(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::nav::CWaypointsNavigator::navigateWaypoints(), mrpt::math::ncc_vector(), mrpt::math::noncentralChi2PDF_CDF(), mrpt::slam::CRangeBearingKFSLAM2D::OnGetObservationsAndDataAssociation(), mrpt::slam::CRangeBearingKFSLAM::OnGetObservationsAndDataAssociation(), mrpt::slam::CRangeBearingKFSLAM2D::OnInverseObservationModel(), mrpt::slam::CRangeBearingKFSLAM::OnInverseObservationModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnNewLandmarkAddedToMap(), mrpt::slam::CRangeBearingKFSLAM::OnNewLandmarkAddedToMap(), mrpt::slam::CRangeBearingKFSLAM::OnNormalizeStateVector(), mrpt::slam::CRangeBearingKFSLAM2D::OnObservationJacobians(), mrpt::slam::CRangeBearingKFSLAM::OnObservationJacobians(), mrpt::slam::CRangeBearingKFSLAM2D::OnObservationModel(), mrpt::slam::CRangeBearingKFSLAM::OnObservationModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnPreComputingPredictions(), mrpt::slam::CRangeBearingKFSLAM::OnPreComputingPredictions(), mrpt::opengl::CPointCloudColoured::onUpdateBuffers_Points(), mrpt::opengl::CPointCloud::onUpdateBuffers_Points(), mrpt::math::MatrixVectorBase< T, CMatrixFixed< T, ROWS, COLS > >::operator*(), mrpt::kinematics::CVehicleVelCmd::operator=(), mrpt::math::operator>>(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::slam::CMetricMapBuilderICP::processObservation(), mrpt::math::ransac2Dline_distance(), mrpt::io::CPipeBaseEndPoint::Read(), mrpt::hwdrivers::readConfigIntoVideoSourcePanel(), readFileWithPoses(), mrpt::hwdrivers::CVelodyneScanner::receivePackets(), mrpt::vision::reprojectionResiduals(), mrpt::apps::RBPF_SLAM_App_Base::run(), mrpt::apps::KFSLAMApp::Run_KF_SLAM(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::img::TCamera::scaleToResolution(), mrpt::tfest::se3_l2_robust(), mrpt::kinematics::CVehicleSimul_Holo::sendVelCmd(), mrpt::kinematics::CVehicleSimul_DiffDriven::sendVelCmd(), mrpt::apps::ICP_SLAM_App_Live::SensorThread(), mrpt::io::CPipeBaseEndPoint::serialize(), mrpt::hmtslam::CHMHMapArc::serializeFrom(), mrpt::obs::CObservationPointCloud::setAsExternalStorage(), mrpt::math::MatrixVectorBase< T, CMatrixFixed< T, ROWS, COLS > >::setConstant(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::setRefDistance(), mrpt::hwdrivers::CKinect::setTiltAngleDegrees(), mrpt::math::MatrixVectorBase< T, CMatrixFixed< T, ROWS, COLS > >::setZero(), mrpt::nav::PlannerRRT_SE2_TPS::solve(), mrpt::math::detail::stub_kmeans(), mrpt::system::CFileSystemWatcher::thread_win32_watch(), mrpt::system::timestampToParts(), mrpt::img::CImage::undistort(), mrpt::obs::detail::unprojectInto(), mrpt::math::CSparseMatrix::CholeskyDecomp::update(), mrpt::kinematics::CKinematicChain::update3DObject(), mrpt::graphs::ScalarFactorGraph::updateEstimation(), mrpt::maps::CRandomFieldGridMap3D::updateMapEstimation(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::updateTPObstacle(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::updateTPObstacleSingle(), mrpt::hwdrivers::CSickLaserSerial::waitContinuousSampleFrame(), mrpt::io::CPipeBaseEndPoint::Write(), mrpt::hwdrivers::writeConfigFromVideoSourcePanel(), and mrpt::system::COutputLogger::writeLogToFile().

◆ MRPT_CHECK_NORMAL_NUMBER

#define MRPT_CHECK_NORMAL_NUMBER (   v)

◆ MRPT_END

#define MRPT_END   MRPT_TRY_END
Examples:
core_exceptions_example/test.cpp.

Definition at line 245 of file exceptions.h.

Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::_optimizeGraph(), mrpt::comms::CServerTCPSocket::accept(), mrpt::vision::add_3d_deltas_to_points(), mrpt::slam::CIncrementalMapPartitioner::addMapFrame(), mrpt::graphslam::TSlidingWindow::addNewMeasurement(), mrpt::gui::CDisplayWindowPlots::addPopupMenuEntry(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::addScanMatchingEdges(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::addToPaths(), mrpt::slam::CICP::Align3DPDF(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::alignOpticalWithMRPTFrame(), mrpt::slam::CGridMapAligner::AlignPDF(), mrpt::slam::CICP::AlignPDF(), mrpt::slam::CGridMapAligner::AlignPDF_correlation(), mrpt::slam::CGridMapAligner::AlignPDF_robustMatch(), mrpt::poses::CPose3DPDFSOG::appendFrom(), mrpt::hmtslam::CHMTSLAM::areaAbstraction(), mrpt::hmtslam::CHierarchicalMapMHPartition::areNodesNeightbour(), mrpt::obs::CRawlog::asObservation(), mrpt::opengl::CRenderizableShaderTexturedTriangles::assignImage(), mrpt::opengl::CMeshFast::assignImage(), mrpt::opengl::CMesh::assignImage(), mrpt::opengl::CMeshFast::assignImageAndZ(), mrpt::opengl::CMesh::assignImageAndZ(), mrpt::maps::CMultiMetricMap::auxParticleFilterCleanUp(), mrpt::math::averageLogLikelihood(), mrpt::vision::ba_compute_Jacobians(), mrpt::maps::CPointsMap::base_copyFrom(), mrpt::poses::CPoint2DPDFGaussian::bayesianFusion(), mrpt::poses::CPointPDFGaussian::bayesianFusion(), mrpt::poses::CPointPDFParticles::bayesianFusion(), mrpt::poses::CPose3DPDFSOG::bayesianFusion(), mrpt::maps::CBeacon::bayesianFusion(), mrpt::poses::CPosePDFGaussian::bayesianFusion(), mrpt::poses::CPose3DPDFGaussian::bayesianFusion(), mrpt::poses::CPosePDFGaussianInf::bayesianFusion(), mrpt::poses::CPointPDFSOG::bayesianFusion(), mrpt::poses::CPosePDFSOG::bayesianFusion(), mrpt::maps::CPointsMap::boundingBox(), mrpt::nav::CAbstractPTGBasedReactive::calc_move_candidate_scores(), mrpt::hwdrivers::CBoardSonars::CBoardSonars(), mrpt::comms::CClientTCPSocket::CClientTCPSocket(), mrpt::config::CConfigFile::CConfigFile(), mrpt::opengl::CFBORender::CFBORender(), mrpt::io::CFileGZInputStream::CFileGZInputStream(), mrpt::io::CFileGZOutputStream::CFileGZOutputStream(), mrpt::io::CFileInputStream::CFileInputStream(), mrpt::io::CFileOutputStream::CFileOutputStream(), mrpt::system::CFileSystemWatcher::CFileSystemWatcher(), mrpt::hwdrivers::CImageGrabber_dc1394::changeCaptureOptions(), mrpt::img::CMappedImage::changeCoordinates(), mrpt::slam::CIncrementalMapPartitioner::changeCoordinatesOriginPoseIndex(), mrpt::poses::CPose3DQuatPDFGaussianInf::changeCoordinatesReference(), mrpt::maps::CBeacon::changeCoordinatesReference(), mrpt::poses::CPose3DQuatPDFGaussian::changeCoordinatesReference(), mrpt::poses::CPose3DPDFGaussianInf::changeCoordinatesReference(), mrpt::poses::CPose3DPDFGaussian::changeCoordinatesReference(), mrpt::hwdrivers::CRoboPeakLidar::checkCOMMs(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::checkForLoopClosures(), mrpt::detectors::CFaceDetection::checkIfDiagonalSurface(), mrpt::detectors::CFaceDetection::checkIfDiagonalSurface2(), mrpt::detectors::CFaceDetection::checkIfFaceRegions(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkOptimizerExists(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::checkPartitionsForLC(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::checkRegistrationCondition(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::checkRegistrationCondition(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::checkRegistrationCondition(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::checkRegistrationCondition2D(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::checkRegistrationCondition2D(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::checkRegistrationCondition3D(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkRegistrationDeciderExists(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::CICPCriteriaERD(), mrpt::img::CImage::CImage(), mrpt::hwdrivers::CImageGrabber_dc1394::CImageGrabber_dc1394(), mrpt::hwdrivers::CImageGrabber_OpenCV::CImageGrabber_OpenCV(), mrpt::comms::CInterfaceFTDI::CInterfaceFTDI(), mrpt::hmtslam::CPropertiesValuesList::clear(), mrpt::hmtslam::CMHPropertiesValuesList::clear(), mrpt::gui::CDisplayWindowPlots::clear(), mrpt::comms::CSerialPort::close(), mrpt::comms::CClientTCPSocket::close(), mrpt::comms::CInterfaceFTDI::Close(), mrpt::io::CMemoryStream::CMemoryStream(), mrpt::maps::CMultiMetricMap::CMultiMetricMap(), mrpt::hwdrivers::CMyntEyeCamera::CMyntEyeCamera(), mrpt::maps::COccupancyGridMap2D::COccupancyGridMap2D(), mrpt::maps::COccupancyGridMap3D::COccupancyGridMap3D(), mrpt::img::colormap(), mrpt::maps::CPointsMap::compute3DDistanceToMesh(), mrpt::maps::CBeaconMap::compute3DMatchingRatio(), mrpt::maps::CMultiMetricMap::compute3DMatchingRatio(), mrpt::maps::CLandmarksMap::compute3DMatchingRatio(), mrpt::maps::CMetricMap::compute3DMatchingRatio(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeCentroidOfNodesVector(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeCoordinatesTransformationBetweenNodes(), mrpt::vision::CFeatureExtraction::computeDescriptors(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeGloballyConsistentNodeCoordinates(), mrpt::poses::CPointPDFParticles::computeKurtosis(), mrpt::maps::CLandmarksMap::computeLikelihood_RSLC_2007(), mrpt::maps::COccupancyGridMap2D::computeLikelihoodField_II(), mrpt::maps::COccupancyGridMap2D::computeLikelihoodField_Thrun(), mrpt::vision::computeMainOrientation(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::maps::CLandmarksMap::computeMatchingWith2D(), mrpt::maps::CBeaconMap::computeMatchingWith3DLandmarks(), mrpt::maps::CLandmarksMap::computeMatchingWith3DLandmarks(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeMatchProbabilityBetweenNodes(), mrpt::maps::COccupancyGridMap2D::computeObservationLikelihood_likelihoodField_II(), mrpt::maps::COccupancyGridMap2D::computeObservationLikelihood_likelihoodField_Thrun(), mrpt::maps::COccupancyGridMap2D::computeObservationLikelihood_MI(), mrpt::slam::CRangeBearingKFSLAM::computeOffDiagonalBlocksApproximationError(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeOverlapProbabilityBetweenNodes(), mrpt::bayes::CParticleFilterCapable::computeResampling(), mrpt::vision::computeSAD(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeSlamMetric(), mrpt::math::confidenceIntervals(), mrpt::comms::CClientTCPSocket::connect(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::convert3DTo2DRangeScan(), mrpt::poses::CPose3DPDFParticles::copyFrom(), mrpt::poses::CPosePDFParticles::copyFrom(), mrpt::poses::CPose3DPDFSOG::copyFrom(), mrpt::maps::CBeacon::copyFrom(), mrpt::poses::CPose3DPDFGaussian::copyFrom(), mrpt::poses::CPointPDFSOG::copyFrom(), mrpt::poses::CPosePDFSOG::copyFrom(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::createDeciderOptimizerMappings(), mrpt::poses::CPose3DPDF::createFrom2D(), mrpt::poses::CPose3DQuatPDF::createFrom2D(), mrpt::nav::CParameterizedTrajectoryGenerator::CreatePTG(), mrpt::opengl::COpenGLScene::createViewport(), mrpt::gui::CBaseGUIWindow::createWxWindow(), mrpt::hwdrivers::CRoboticHeadInterface::CRoboticHeadInterface(), mrpt::math::cross_correlation_FFT(), mrpt::img::CImage::cross_correlation_FFT(), mrpt::hwdrivers::CSickLaserUSB::CSickLaserUSB(), mrpt::slam::data_association_full_covariance(), mrpt::slam::data_association_independent_predictions(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::decimateLaserScan(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::decimatePointsMap(), mrpt::system::deleteFiles(), mrpt::maps::CHeightGridMap2D_Base::dem_internal_insertObservation(), mrpt::vision::CFeature::descriptorDistanceTo(), mrpt::vision::CFeature::descriptorLogPolarImgDistanceTo(), mrpt::vision::CFeature::descriptorPolarImgDistanceTo(), mrpt::serialization::CMessage::deserializeIntoExistingObject(), mrpt::serialization::CMessage::deserializeIntoNewObject(), mrpt::gui::CBaseGUIWindow::destroyWxWindow(), mrpt::detectors::CFaceDetection::detectObjects_Impl(), mrpt::maps::CMultiMetricMap::determineMatching2D(), mrpt::maps::CMetricMap::determineMatching2D(), mrpt::maps::CBeaconMap::determineMatching2D(), mrpt::maps::COccupancyGridMap3D::determineMatching2D(), mrpt::maps::CPointsMap::determineMatching2D(), mrpt::maps::COccupancyGridMap2D::determineMatching2D(), mrpt::maps::CMetricMap::determineMatching3D(), mrpt::maps::CPointsMap::determineMatching3D(), mrpt::math::dft2_complex(), mrpt::math::dft2_real(), do_rectify(), mrpt::poses::CPoseRandomSampler::do_sample_2D(), mrpt::poses::CPoseRandomSampler::do_sample_3D(), mrpt::slam::CMetricMapBuilderRBPF::drawCurrentEstimationToImage(), mrpt::img::CCanvas::drawImage(), mrpt::poses::CPose3DQuatPDFGaussianInf::drawManySamples(), mrpt::poses::CPose3DQuatPDFGaussian::drawManySamples(), mrpt::poses::CPose3DPDFGaussianInf::drawManySamples(), mrpt::poses::CPosePDFGaussian::drawManySamples(), mrpt::poses::CPose3DPDFGaussian::drawManySamples(), mrpt::poses::CPosePDFGaussianInf::drawManySamples(), mrpt::poses::CPosePDFSOG::drawManySamples(), mrpt::poses::CPoseRandomSampler::drawSample(), mrpt::poses::CPoint2DPDFGaussian::drawSingleSample(), mrpt::poses::CPose3DQuatPDFGaussianInf::drawSingleSample(), mrpt::poses::CPose3DQuatPDFGaussian::drawSingleSample(), mrpt::maps::CBeacon::drawSingleSample(), mrpt::poses::CPointPDFGaussian::drawSingleSample(), mrpt::poses::CPointPDFSOG::drawSingleSample(), mrpt::poses::CPosePDFSOG::drawSingleSample(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpOptimizersToConsole(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpRegistrarsToConsole(), mrpt::graphslam::TSlidingWindow::dumpToTextStream(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::dumpToTextStream(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::dumpToTextStream(), mrpt::maps::TSetOfMetricMapInitializers::dumpToTextStream(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLaserParams::dumpToTextStream(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLoopClosureParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::dumpVisibilityErrorMsg(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::dumpVisibilityErrorMsg(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::dumpVisibilityErrorMsg(), mrpt::poses::CPointPDFSOG::enforceCovSymmetry(), mrpt::poses::CPose3DPDFSOG::enforceCovSymmetry(), mrpt::hwdrivers::CHokuyoURG::ensureStreamIsOpen(), mrpt::hwdrivers::CImageGrabber_dc1394::enumerateCameras(), mrpt::obs::CActionCollection::erase(), mrpt::obs::CSensoryFrame::erase(), mrpt::obs::CSensoryFrame::eraseByIndex(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::ESS(), mrpt::poses::CPointPDFSOG::ESS(), mrpt::math::estimateJacobian(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evalPWConsistenciesMatrix(), mrpt::graphslam::TSlidingWindow::evaluateMeasurementAbove(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evaluatePartitionsForLC(), mrpt::poses::CPointPDFSOG::evaluatePDFInArea(), mrpt::poses::CPosePDFSOG::evaluatePDFInArea(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::execDijkstraProjection(), mrpt::math::RANSAC_Template< NUMTYPE, DATASET, MODEL >::execute(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::bayes::CParticleFilter::executeOn(), mrpt::system::CDirectoryExplorer::explore(), mrpt::system::extractDayTimeFromTimestamp(), mrpt::vision::CFeatureExtraction::extractFeaturesAKAZE(), mrpt::vision::CFeatureExtraction::extractFeaturesFAST(), mrpt::vision::CFeatureExtraction::extractFeaturesKLT(), mrpt::vision::CFeatureExtraction::extractFeaturesLSD(), mrpt::vision::CFeatureExtraction::extractFeaturesORB(), mrpt::bayes::CParticleFilterCapable::fastDrawSample(), mrpt::math::fft_real(), mrpt::maps::CPointCloudFilterByDistance::filter(), mrpt::obs::CObservation2DRangeScan::filterByExclusionAngles(), mrpt::obs::CObservation2DRangeScan::filterByExclusionAreas(), mrpt::vision::find_descriptor_pairings(), mrpt::hmtslam::CHierarchicalMapMHPartition::findArcOfTypeBetweenNodes(), mrpt::hmtslam::CHierarchicalMapMHPartition::findArcsBetweenNodes(), mrpt::hmtslam::CHierarchicalMapMHPartition::findArcsOfTypeBetweenNodes(), mrpt::vision::findChessboardCorners(), mrpt::obs::CRawlog::findObservationsByClassInRange(), mrpt::hmtslam::CHierarchicalMapMHPartition::findPathBetweenNodes(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::fitGraphInView(), mrpt::maps::COccupancyGridMap2D::freeMap(), mrpt::obs::CObservationRotatingScan::fromGeneric(), mrpt::obs::CObservationRotatingScan::fromPointCloud(), mrpt::math::CQuaternion< T >::fromRodriguesVector(), mrpt::ros1bridge::fromROS(), mrpt::obs::CObservationRotatingScan::fromScan2D(), mrpt::math::CVectorDynamic< KFTYPE >::fromVectorLike(), mrpt::obs::CObservationRotatingScan::fromVelodyne(), mrpt::comms::CInterfaceFTDI::ftdi_getQueueStatus(), mrpt::comms::CInterfaceFTDI::ftdi_listDevices(), mrpt::comms::CInterfaceFTDI::ftdi_open(), mrpt::comms::CInterfaceFTDI::ftdi_openEx(), mrpt::comms::CInterfaceFTDI::ftdi_read(), mrpt::comms::CInterfaceFTDI::ftdi_write(), mrpt::maps::CLandmarksMap::fuseWith(), mrpt::math::generateAxisBaseFromDirection(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generateHypotsPool(), mrpt::hmtslam::CHMTSLAM::generateLogFiles(), mrpt::maps::CBeacon::generateObservationModelDistribution(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistenciesMatrix(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistencyElement(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::generateReportFiles(), mrpt::maps::CBeacon::generateRingSOG(), mrpt::obs::CActionCollection::getActionByClass(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::hmtslam::CMHPropertiesValuesList::getAs(), mrpt::maps::CWirelessPowerGridMap2D::getAs3DObject(), mrpt::maps::CHeightGridMap2D_MRF::getAs3DObject(), mrpt::maps::CGasConcentrationGridMap2D::getAs3DObject(), mrpt::maps::CReflectivityGridMap2D::getAs3DObject(), mrpt::maps::CBeacon::getAs3DObject(), mrpt::maps::CMultiMetricMap::getAs3DObject(), mrpt::maps::CBeaconMap::getAs3DObject(), mrpt::maps::CPointsMap::getAs3DObject(), mrpt::maps::COccupancyGridMap2D::getAs3DObject(), mrpt::hmtslam::CHierarchicalMapMHPartition::getAs3DScene(), mrpt::obs::CRawlog::getAsAction(), mrpt::maps::CRandomFieldGridMap2D::getAsBitmapFile(), mrpt::obs::CRawlog::getAsGeneric(), mrpt::maps::CBeacon::getAsMatlabDrawCommands(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::maps::CRandomFieldGridMap2D::getAsMatrix(), mrpt::poses::CPose3DGridTemplate< double >::getAsMatrix(), mrpt::img::CImage::getAsMatrix(), mrpt::img::CImage::getAsMatrixTiled(), mrpt::obs::CRawlog::getAsObservation(), mrpt::obs::CRawlog::getAsObservations(), mrpt::maps::COccupancyGridMap3D::getAsOctoMapVoxels(), mrpt::img::CImage::getAsRGBMatrices(), mrpt::maps::CMultiMetricMap::getAsSimplePointsMap(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::TParams::getAsString(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::getAsString(), mrpt::vision::CMatchedFeatureList::getBothFeatureLists(), mrpt::poses::CPoseInterpolatorBase< 3 >::getBoundingBox(), mrpt::opengl::CSetOfObjects::getByClass(), mrpt::opengl::COpenGLScene::getByClass(), mrpt::opengl::COpenGLViewport::getByClass(), mrpt::opengl::CFBORender::getCamera(), mrpt::serialization::CMessage::getContentAsStruct(), mrpt::config::CConfigFileBase::getContentAsYAML(), mrpt::poses::CPointPDFParticles::getCovarianceAndMean(), mrpt::poses::CPose3DPDFParticles::getCovarianceAndMean(), mrpt::maps::CBeacon::getCovarianceAndMean(), mrpt::slam::CRangeBearingKFSLAM2D::getCurrentRobotPose(), mrpt::slam::CRangeBearingKFSLAM::getCurrentRobotPose(), mrpt::slam::CRangeBearingKFSLAM2D::getCurrentState(), mrpt::slam::CRangeBearingKFSLAM::getCurrentState(), mrpt::system::getcwd(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::getDescriptiveReport(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::getEdgesStats(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getEdgesStats(), mrpt::hmtslam::CMHPropertiesValuesList::getElemental(), mrpt::opengl::CFBORender::getFrame(), mrpt::opengl::CFBORender::getFrame2(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getGraphSlamStats(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::getICPEdge(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getICPEdge(), mrpt::hwdrivers::CJoystick::getJoystickPosition(), mrpt::hwdrivers::CJoystick::getJoysticksCount(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap(), mrpt::vision::CFeatureList::getMaxID(), mrpt::vision::CMatchedFeatureList::getMaxID(), mrpt::poses::CPointPDFParticles::getMean(), mrpt::graphslam::TSlidingWindow::getMean(), mrpt::poses::CPose3DPDFParticles::getMean(), mrpt::maps::CBeacon::getMean(), mrpt::hmtslam::CLocalMetricHypothesis::getMeans(), mrpt::graphslam::TSlidingWindow::getMedian(), mrpt::system::getMemoryUsage(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getMinUncertaintyPath(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getMostLikelyParticle(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::getNearbyNodesOf(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::getNearbyNodesOf(), mrpt::opengl::CRenderizableShaderTexturedTriangles::getNewTextureNumber(), mrpt::hmtslam::CHierarchicalMapMHPartition::getNodeByID(), mrpt::hmtslam::CHierarchicalMapMHPartition::getNodeByLabel(), mrpt::hwdrivers::CImageGrabber_OpenCV::getObservation(), mrpt::hwdrivers::CImageGrabber_dc1394::getObservation(), mrpt::obs::CSensoryFrame::getObservationByClass(), mrpt::obs::CSensoryFrame::getObservationByIndex(), mrpt::obs::CSensoryFrame::getObservationBySensorLabel(), mrpt::poses::CPoseRandomSampler::getOriginalPDFCov2D(), mrpt::poses::CPoseRandomSampler::getOriginalPDFCov3D(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getParamsAsString(), mrpt::hmtslam::CLocalMetricHypothesis::getPathParticles(), mrpt::img::CImage::getPixelDepth(), mrpt::hmtslam::CLocalMetricHypothesis::getPoseParticles(), mrpt::comms::CClientTCPSocket::getPosition(), mrpt::comms::CSerialPort::getPosition(), mrpt::hmtslam::CLocalMetricHypothesis::getRelativePose(), mrpt::poses::CPoseRandomSampler::getSamplingMean2D(), mrpt::poses::CPoseRandomSampler::getSamplingMean3D(), mrpt::graphslam::TSlidingWindow::getStdDev(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getTimeStamp(), mrpt::comms::CClientTCPSocket::getTotalBytesCount(), mrpt::comms::CSerialPort::getTotalBytesCount(), mrpt::obs::CRawlog::getType(), mrpt::opengl::COpenGLScene::getViewport(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getWeights(), mrpt::graphs::detail::graph_ops< graph_t >::graph_edge_sqerror(), mrpt::graphs::detail::graph_ops< graph_t >::graph_of_poses_collapse_dup_edges(), mrpt::graphs::detail::graph_ops< graph_t >::graph_of_poses_dijkstra_init(), mrpt::maps::CLandmarksMap::TCustomSequenceLandmarks::hasBeenModifiedAll(), mrpt::math::homogeneousMatrixInverse(), mrpt::slam::CICP::ICP3D_Method_Classic(), mrpt::slam::CICP::ICP_Method_Classic(), mrpt::slam::CICP::ICP_Method_LM(), mrpt::math::idft2_complex(), mrpt::math::idft2_real(), mrpt::gui::CDisplayWindowPlots::image(), mrpt::apps::DataSourceRawlog::impl_get_next_observations(), mrpt::apps::ICP_SLAM_App_Live::impl_get_next_observations(), mrpt::apps::ICP_SLAM_App_Rawlog::impl_initialize(), mrpt::apps::RBPF_SLAM_App_Rawlog::impl_initialize(), mrpt::apps::ICP_SLAM_App_Live::impl_initialize(), mrpt::apps::MonteCarloLocalization_Rawlog::impl_initialize(), mrpt::nav::CAbstractPTGBasedReactive::impl_waypoint_is_reachable(), IMPLEMENTS_SERIALIZABLE(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initClass(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::initCurrCovarianceVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initCurrPosViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initEstimatedTrajectoryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::initGraphVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initGTVisualization(), mrpt::apps::CGridMapAlignerApp::initialize(), mrpt::apps::KFSLAMApp::initialize(), mrpt::apps::RawlogGrabberApp::initialize(), mrpt::apps::MonteCarloLocalization_Base::initialize(), mrpt::apps::RBPF_SLAM_App_Base::initialize(), mrpt::apps::ICP_SLAM_App_Base::initialize(), mrpt::slam::CMetricMapBuilderICP::initialize(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::initializeVisuals(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::initializeVisuals(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::initializeVisuals(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initIntensityImageViewport(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::initLaserScansVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initOdometryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::initOptDistanceVisualization(), CGraphSlamHandler< GRAPH_T >::initOutputDir(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initRangeImageViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initResultsFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initSlamMetricVisualization(), mrpt::opengl::COpenGLScene::insert(), mrpt::maps::CSimpleMap::insert(), mrpt::maps::CRandomFieldGridMap3D::insertIndividualReading(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KernelDM_DMV(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KF(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KF2(), mrpt::maps::CMetricMap::insertObservationPtr(), mrpt::maps::COccupancyGridMap3D::insertPointCloud(), mrpt::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >::insertPointCloud(), mrpt::maps::COccupancyGridMap3D::insertRay(), mrpt::maps::CSimpleMap::insertToPos(), mrpt::vision::CFeatureExtraction::internal_computeLATCHDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeLogPolarImageDescriptors(), mrpt::maps::CBeaconMap::internal_computeObservationLikelihood(), mrpt::maps::CReflectivityGridMap2D::internal_computeObservationLikelihood(), mrpt::maps::CLandmarksMap::internal_computeObservationLikelihood(), mrpt::maps::CMultiMetricMap::internal_computeObservationLikelihood(), mrpt::vision::CFeatureExtraction::internal_computePolarImageDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeSpinImageDescriptors(), mrpt::vision::CFeature::internal_distanceBetweenPolarImages(), mrpt::img::CImage::internal_fromIPL(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::internal_initialize(), mrpt::maps::CBeaconMap::internal_insertObservation(), mrpt::maps::COccupancyGridMap3D::internal_insertObservation(), mrpt::maps::CWirelessPowerGridMap2D::internal_insertObservation(), mrpt::maps::CLandmarksMap::internal_insertObservation(), mrpt::maps::CReflectivityGridMap2D::internal_insertObservation(), mrpt::maps::CGasConcentrationGridMap2D::internal_insertObservation(), mrpt::maps::CPointsMap::internal_insertObservation(), mrpt::maps::COccupancyGridMap3D::internal_insertObservationScan2D(), mrpt::maps::COccupancyGridMap3D::internal_insertObservationScan3D(), mrpt::system::CObservable::internal_observer_end(), mrpt::gui::CDisplayWindowPlots::internal_plot(), mrpt::hwdrivers::CVelodyneScanner::internal_send_http_post(), mrpt::math::interpolate(), mrpt::math::interpolate2points(), mrpt::maps::CHeightGridMap2D_Base::intersectLine3D(), mrpt::poses::CPose3DPDFParticles::inverse(), mrpt::poses::CPose3DPDFSOG::inverse(), mrpt::poses::CPosePDFParticles::inverse(), mrpt::opengl::CFBORender::isExtensionSupported(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeClosestPoint2D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeClosestPoint3D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint2D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint2DIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3DIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3DWithIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeRadiusSearch2D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeRadiusSearch3D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeTwoClosestPoint2D(), mrpt::math::KLD_Gaussians(), mrpt::maps::COccupancyGridMap2D::laserScanSimulator(), mrpt::math::leastSquareLinearFit(), mrpt::comms::CInterfaceFTDI::ListAllDevices(), mrpt::obs::CObservationPointCloud::load(), mrpt::maps::CPointsMap::load2Dor3D_from_text_file(), mrpt::hwdrivers::CGenericSensor::loadConfig(), mrpt::hwdrivers::CWirelessPower::loadConfig_sensorSpecific(), mrpt::hwdrivers::CImpinjRFID::loadConfig_sensorSpecific(), mrpt::hwdrivers::CEnoseModular::loadConfig_sensorSpecific(), mrpt::hwdrivers::CBoardENoses::loadConfig_sensorSpecific(), mrpt::hwdrivers::CBoardSonars::loadConfig_sensorSpecific(), mrpt::hwdrivers::CVelodyneScanner::loadConfig_sensorSpecific(), mrpt::nav::CReactiveNavigationSystem::loadConfigFile(), mrpt::nav::CReactiveNavigationSystem3D::loadConfigFile(), mrpt::nav::CWaypointsNavigator::loadConfigFile(), mrpt::nav::CAbstractNavigator::loadConfigFile(), mrpt::nav::CAbstractPTGBasedReactive::loadConfigFile(), mrpt::opengl::COpenGLViewport::loadDefaultShaders(), mrpt::comms::CInterfaceFTDI::loadDriver(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::loadFromArray(), mrpt::maps::COccupancyGridMap2D::loadFromBitmap(), mrpt::maps::COccupancyGridMap2D::loadFromBitmapFile(), mrpt::slam::CIncrementalMapPartitioner::TOptions::loadFromConfigFile(), mrpt::nav::CHolonomicVFF::TOptions::loadFromConfigFile(), mrpt::graphslam::TSlidingWindow::loadFromConfigFile(), mrpt::slam::CMetricMapBuilderRBPF::TConstructionOptions::loadFromConfigFile(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::nav::CHolonomicND::TOptions::loadFromConfigFile(), mrpt::bayes::CParticleFilter::TParticleFilterOptions::loadFromConfigFile(), mrpt::nav::CHolonomicFullEval::TOptions::loadFromConfigFile(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::loadFromConfigFile(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::loadFromConfigFile(), mrpt::nav::CAbstractPTGBasedReactive::TAbstractPTGNavigatorParams::loadFromConfigFile(), mrpt::maps::TSetOfMetricMapInitializers::loadFromConfigFile(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLaserParams::loadFromConfigFile(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLoopClosureParams::loadFromConfigFile(), mrpt::img::CImage::loadFromFile(), mrpt::img::CImage::loadFromMemoryBuffer(), mrpt::opengl::CPointCloud::loadFromPointsList(), mrpt::img::CImage::loadFromStreamAsJPEG(), mrpt::poses::CPoseInterpolatorBase< 3 >::loadFromTextFile(), mrpt::vision::TSequenceFeatureObservations::loadFromTextFile(), mrpt::vision::CFeatureList::loadFromTextFile(), mrpt::graphslam::deciders::CRangeScanEdgeRegistrationDecider< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::loadParams(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::loadParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::loadParams(), mrpt::maps::CLandmarksMap::loadSiftFeaturesFromStereoImageObservation(), mrpt::maps::CPointsMapXYZI::loadXYZI_from_text_file(), mrpt::bayes::CParticleFilterCapable::log2linearWeights(), mrpt::hmtslam::CHMTSLAM::loopClosureDetector_factory(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_AA(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_TBI(), mrpt::math::mahalanobisDistance2(), mrpt::math::mahalanobisDistance2AndLogPDF(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::mahalanobisDistanceOdometryToICPEdge(), mrpt::poses::CPose3DQuatPDFGaussian::mahalanobisDistanceTo(), mrpt::poses::CPosePDFGaussian::mahalanobisDistanceTo(), mrpt::poses::CPosePDFGaussianInf::mahalanobisDistanceTo(), mrpt::poses::CPose3DPDFGaussianInf::mahalanobisDistanceTo(), mrpt::poses::CPose3DPDFGaussian::mahalanobisDistanceTo(), mrpt::maps::CMultiMetricMap::mapByIndex(), mrpt::vision::matchFeatures(), mrpt::math::MATLAB_plotCovariance2D(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::poses::CPosePDFSOG::mergeModes(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::math::multiply_A_skew3(), mrpt::math::multiply_skew3_A(), mrpt::nav::CAbstractNavigator::navigate(), mrpt::nav::CWaypointsNavigator::navigateWaypoints(), mrpt::nav::CWaypointsNavigator::navigationStep(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::normalizeWeights(), mrpt::poses::CPose3DPDFSOG::normalizeWeights(), mrpt::poses::CPointPDFSOG::normalizeWeights(), mrpt::poses::CPosePDFSOG::normalizeWeights(), mrpt::math::normalPDF(), mrpt::math::normalPDFInf(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::notifyOfWindowEvents(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::notifyOfWindowEvents(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::notifyOfWindowEvents(), mrpt::hmtslam::CHMHMapNode::onArcAddition(), mrpt::hmtslam::CHMHMapNode::onArcDestruction(), mrpt::slam::CRangeBearingKFSLAM2D::OnGetObservationsAndDataAssociation(), mrpt::slam::CRangeBearingKFSLAM::OnGetObservationsAndDataAssociation(), mrpt::slam::CRangeBearingKFSLAM2D::OnInverseObservationModel(), mrpt::slam::CRangeBearingKFSLAM::OnInverseObservationModel(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnNewLandmarkAddedToMap(), mrpt::slam::CRangeBearingKFSLAM::OnNewLandmarkAddedToMap(), mrpt::hmtslam::CHMHMapArc::onNodeDestruction(), mrpt::slam::CRangeBearingKFSLAM::OnNormalizeStateVector(), mrpt::slam::CRangeBearingKFSLAM2D::OnObservationJacobians(), mrpt::slam::CRangeBearingKFSLAM::OnObservationJacobians(), mrpt::slam::CRangeBearingKFSLAM2D::OnObservationModel(), mrpt::slam::CRangeBearingKFSLAM::OnObservationModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionJacobian(), mrpt::slam::CRangeBearingKFSLAM::OnTransitionJacobian(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionModel(), mrpt::slam::CRangeBearingKFSLAM::OnTransitionModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionNoise(), mrpt::slam::CRangeBearingKFSLAM::OnTransitionNoise(), mrpt::opengl::CTexturedPlane::onUpdateBuffers_TexturedTriangles(), mrpt::io::CFileGZInputStream::open(), mrpt::io::CFileGZOutputStream::open(), mrpt::comms::CSerialPort::open(), mrpt::comms::CInterfaceFTDI::OpenByDescription(), mrpt::comms::CInterfaceFTDI::OpenBySerialNumber(), mrpt::vision::openCV_cross_correlation(), mrpt::img::CImage::operator()(), mrpt::maps::CSimpleMap::operator=(), mrpt::obs::CSensoryFrame::operator=(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::operator=(), mrpt::math::CVectorDynamic< KFTYPE >::operator=(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator=(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::optimizeGraph(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::particlesEvaluator_AuxPFOptimal(), mrpt::vision::CFeature::patchCorrelationTo(), mrpt::topography::path_from_rtk_gps(), mrpt::hmtslam::CHMTSLAM::perform_TLC(), mrpt::bayes::CParticleFilterCapable::performResampling(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::performSubstitution(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfStandardProposal(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::gui::CDisplayWindow::plot(), mrpt::gui::CDisplayWindowPlots::plotEllipse(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::popMinUncertaintyPath(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::populateDeciderOptimizerProperties(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfOptimalProposal(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::prediction_and_update_pfOptimalProposal(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfStandardProposal(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfStandardProposal(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfStandardProposal(), mrpt::maps::CRandomFieldGridMap2D::predictMeasurement(), mrpt::bayes::CParticleFilterCapable::prepareFastDrawSample(), mrpt::obs::CActionRobotMovement2D::prepareFastDrawSingleSample_modelGaussian(), mrpt::io::CStream::printf(), mrpt::graphslam::deciders::CRangeScanEdgeRegistrationDecider< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::printParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::printParams(), mrpt::detectors::CDetectorDoorCrossing::process(), mrpt::slam::CRangeBearingKFSLAM2D::processActionObservation(), mrpt::slam::CRangeBearingKFSLAM::processActionObservation(), mrpt::slam::CMetricMapBuilderRBPF::processActionObservation(), mrpt::nav::CAbstractNavigator::processNavigateCommand(), mrpt::slam::CMetricMapBuilderICP::processObservation(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::processOneLMH(), mrpt::poses::CRobot2DPoseEstimator::processUpdateNewOdometry(), mrpt::poses::CPoint2DPDFGaussian::productIntegralWith(), mrpt::poses::CPointPDFGaussian::productIntegralWith(), mrpt::poses::CPointPDFGaussian::productIntegralWith2D(), mrpt::vision::projectMatchedFeatures(), mrpt::vision::pinhole::projectPoints_no_distortion(), mrpt::vision::pinhole::projectPoints_with_distortion(), mrpt::system::CObservable::publishEvent(), mrpt::comms::CInterfaceFTDI::Purge(), mrpt::comms::CSerialPort::purgeBuffers(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::queryObserverForEvents(), mrpt::math::ransac_detect_2D_lines(), mrpt::comms::CClientTCPSocket::Read(), mrpt::comms::CSerialPort::Read(), mrpt::config::CConfigFileBase::read_enum(), mrpt::comms::CClientTCPSocket::readAsync(), mrpt::gui::CPanelCameraSelection::readConfigIntoVideoSourcePanel(), mrpt::hwdrivers::readConfigIntoVideoSourcePanel(), readFileWithPoses(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFileRGBD_TUM(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::readParticlesFromStream(), mrpt::config::CConfigFile::readString(), mrpt::config::CConfigFileMemory::readString(), mrpt::maps::CMultiMetricMapPDF::rebuildAverageMap(), mrpt::serialization::CArchive::receiveMessage(), mrpt::obs::CObservation3DRangeScan::recoverCameraCalibrationParameters(), mrpt::vision::CStereoRectifyMap::rectify(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::registerNewEdge(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::registerNewNodeAtEnd(), mrpt::bayes::CRejectionSamplingCapable< CPose2D >::rejectionSampling(), mrpt::opengl::CRenderizableShaderTexturedTriangles::releaseTextureName(), mrpt::maps::CSimpleMap::remove(), mrpt::obs::CRawlog::remove(), mrpt::hmtslam::CLocalMetricHypothesis::removeAreaFromLMH(), mrpt::vision::TSequenceFeatureObservations::removeFewObservedFeatures(), mrpt::opengl::COpenGLScene::removeObject(), mrpt::slam::CIncrementalMapPartitioner::removeSetOfNodes(), mrpt::opengl::COpenGLScene::render(), mrpt::opengl::COpenGLViewport::render(), mrpt::opengl::COpenGLViewport::renderNormalSceneMode(), mrpt::opengl::COpenGLViewport::renderTextMessages(), mrpt::opengl::COpenGLViewport::renderViewportBorder(), mrpt::vision::reprojectionResiduals(), mrpt::poses::CPosePDFParticles::resetAroundSetOfPoses(), mrpt::comms::CInterfaceFTDI::ResetDevice(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::resetPDF(), mrpt::poses::CPose3DPDFParticles::resetUniform(), mrpt::poses::CPosePDFParticles::resetUniform(), mrpt::slam::CMonteCarloLocalization2D::resetUniformFreeSpace(), mrpt::opengl::CFBORender::resize(), mrpt::maps::CRandomFieldGridMap3D::resize(), mrpt::img::CImage::resize(), mrpt::maps::CRandomFieldGridMap2D::resize(), mrpt::maps::COccupancyGridMap3D::resizeGrid(), mrpt::graphslam::TSlidingWindow::resizeWindow(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::RS_drawFromProposal(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::RS_observationLikelihood(), mrpt::apps::CGridMapAlignerApp::run(), mrpt::apps::KFSLAMApp::run(), mrpt::apps::RawlogGrabberApp::run(), MapExecutor::run(), mrpt::apps::RBPF_SLAM_App_Base::run(), mrpt::apps::MonteCarloLocalization_Base::run(), mrpt::apps::ICP_SLAM_App_Base::run(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::save3DScene(), mrpt::maps::CRandomFieldGridMap2D::saveAsBitmapFile(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFile(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapTwoMapsWithCorrespondences(), mrpt::maps::COccupancyGridMap2D::saveAsEMFTwoMapsWithCorrespondences(), mrpt::maps::CRandomFieldGridMap2D::saveAsMatlab3DGraph(), mrpt::vision::TSequenceFeatureObservations::saveAsSBAFiles(), mrpt::slam::CMetricMapBuilderICP::saveCurrentEstimationToImage(), mrpt::slam::CMetricMapBuilderRBPF::saveCurrentEstimationToImage(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::saveGraph(), mrpt::maps::CMultiMetricMap::saveMetricMapRepresentationToFile(), mrpt::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >::saveMetricMapRepresentationToFile(), mrpt::maps::CBeaconMap::saveMetricMapRepresentationToFile(), mrpt::maps::CLandmarksMap::saveMetricMapRepresentationToFile(), mrpt::nav::CPTG_DiffDrive_CS::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_CCS::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_CC::saveToConfigFile(), mrpt::nav::CPTG_Holo_Blend::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_alpha::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_C::saveToConfigFile(), mrpt::nav::CHolonomicVFF::TOptions::saveToConfigFile(), mrpt::nav::CHolonomicND::TOptions::saveToConfigFile(), mrpt::nav::CHolonomicFullEval::TOptions::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::saveToConfigFile(), mrpt::nav::CParameterizedTrajectoryGenerator::saveToConfigFile(), mrpt::img::CImage::saveToFile(), mrpt::img::CImage::saveToStreamAsJPEG(), mrpt::poses::CPoint2DPDFGaussian::saveToTextFile(), mrpt::poses::CPointPDFGaussian::saveToTextFile(), mrpt::poses::CPointPDFParticles::saveToTextFile(), mrpt::maps::CBeacon::saveToTextFile(), mrpt::vision::TSequenceFeatureObservations::saveToTextFile(), mrpt::vision::CFeature::saveToTextFile(), mrpt::vision::CFeatureList::saveToTextFile(), mrpt::maps::CBeaconMap::saveToTextFile(), mrpt::maps::CLandmarksMap::saveToTextFile(), mrpt::tfest::se2_l2(), se3_l2_internal(), mrpt::tfest::se3_l2_robust(), mrpt::comms::CClientTCPSocket::Seek(), mrpt::comms::CSerialPort::Seek(), mrpt::hwdrivers::CHokuyoURG::sendCmd(), mrpt::serialization::CArchive::sendMessage(), mrpt::obs::CSensoryFrame::serializeFrom(), mrpt::serialization::CMessage::serializeObject(), mrpt::maps::CSimpleMap::set(), mrpt::obs::CObservationPointCloud::setAsExternalStorage(), mrpt::opengl::CFBORender::setCamera(), mrpt::comms::CSerialPort::setConfig(), mrpt::config::CConfigFileBase::setContentFromYAML(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::setCovMatrixAndMean(), mrpt::config::CConfigFile::setFileName(), mrpt::hwdrivers::CVelodyneScanner::setFramePublishing(), mrpt::vision::CUndistortMap::setFromCamParams(), mrpt::vision::CStereoRectifyMap::setFromCamParams(), mrpt::img::CImage::setFromMatrix(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::setFromMatrixLike(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::setFromMatrixLike(), mrpt::img::CImage::setFromRGBMatrices(), mrpt::hwdrivers::CGPSInterface::setJAVAD_AIM_mode(), mrpt::comms::CInterfaceFTDI::SetLatencyTimer(), mrpt::hwdrivers::CVelodyneScanner::setLidarOnOff(), mrpt::hwdrivers::CVelodyneScanner::setLidarReturnType(), mrpt::hwdrivers::CVelodyneScanner::setLidarRPM(), mrpt::opengl::CSetOfLines::setLineByIndex(), mrpt::maps::CMultiMetricMap::setListOfMaps(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::setObjectPropsFromNodeID(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::setParams(), mrpt::img::CImage::setPixel(), mrpt::poses::CPoseRandomSampler::setPosePDF(), mrpt::maps::COccupancyGridMap3D::setSize(), mrpt::maps::CRandomFieldGridMap3D::setSize(), mrpt::maps::COccupancyGridMap2D::setSize(), mrpt::hwdrivers::CImageGrabber_dc1394::setSoftwareTriggerLevel(), mrpt::comms::CSerialPort::setTimeouts(), mrpt::comms::CInterfaceFTDI::SetTimeouts(), mrpt::comms::CServerTCPSocket::setupSocket(), mrpt::opengl::COpenGLViewport::setViewportPosition(), mrpt::graphslam::detail::CEdgeCounter::setWindowManagerPtr(), mrpt::math::CSplineInterpolator1D::setXY(), mrpt::gui::CDisplayWindow::showImage(), mrpt::gui::CDisplayWindow::showImageAndPoints(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::gui::CDisplayWindow::showTiledImageAndPoints(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::maps::CMetricMap::squareDistanceToClosestCorrespondence(), mrpt::math::detail::stub_kmeans(), mrpt::hmtslam::CHMTSLAM::TBI_main_method(), test_except_2nd_lvl(), test_except_3rd_lvl(), test_except_toplevel(), mrpt::img::CCanvas::textOut(), mrpt::system::timeDifference(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleEstimatedTrajectoryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::toggleGraphVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleGTVisualization(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::toggleLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::toggleLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::toggleMapPartitionsVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleMapVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleOdometryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::toggleOptDistanceVisualization(), mrpt::vision::CFeatureTracker_KL::trackFeatures_impl_templ(), mrpt::math::transform_gaussian_linear(), mrpt::math::transform_gaussian_montecarlo(), mrpt::math::transform_gaussian_unscented(), mrpt::hwdrivers::CHokuyoURG::turnOn(), mrpt::vision::CUndistortMap::undistort(), mrpt::vision::pinhole::undistort_point(), mrpt::vision::pinhole::undistort_points(), mrpt::obs::CObservationPointCloud::unload(), mrpt::hwdrivers::CGPSInterface::unsetJAVAD_AIM_mode(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateAllVisuals(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateCurrCovarianceVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateCurrPosViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateEstimatedTrajectoryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateGraphVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateGTVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateIntensityImageViewport(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateMapPartitions(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateMapVisualization(), mrpt::vision::CMatchedFeatureList::updateMaxID(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateOdometryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateOptDistanceVisualization(), mrpt::slam::CIncrementalMapPartitioner::updatePartitions(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateRangeImageViewport(), mrpt::maps::CMultiMetricMapPDF::updateSensoryFrameSequence(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateSlamMetricVisualization(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::updateState(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::updateState2D(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::updateVisuals(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateVisuals(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateVisuals(), mrpt::opengl::COpenGLScene::visitAllObjects(), mrpt::nav::CWaypointsNavigator::waypoints_navigationStep(), mrpt::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), mrpt::comms::CClientTCPSocket::Write(), mrpt::comms::CSerialPort::Write(), mrpt::comms::CClientTCPSocket::writeAsync(), mrpt::gui::CPanelCameraSelection::writeConfigFromVideoSourcePanel(), mrpt::hwdrivers::writeConfigFromVideoSourcePanel(), mrpt::config::CConfigFile::writeNow(), mrpt::serialization::CArchive::WriteObject(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::writeParticlesToStream(), mrpt::config::CConfigFile::writeString(), mrpt::config::CConfigFileMemory::writeString(), and mrpt::gui::WxSubsystem::wxMainThread().

◆ MRPT_END_WITH_CLEAN_UP

#define MRPT_END_WITH_CLEAN_UP (   stuff)    MRPT_TRY_END_WITH_CLEAN_UP(stuff)

◆ MRPT_PROFILE_FUNC_START

#define MRPT_PROFILE_FUNC_START

Definition at line 234 of file exceptions.h.

Referenced by mrpt::opengl::processRenderQueue().

◆ MRPT_START

#define MRPT_START
Value:
MRPT_PROFILE_FUNC_START \
MRPT_TRY_START
Examples:
core_exceptions_example/test.cpp.

Definition at line 241 of file exceptions.h.

Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::_optimizeGraph(), mrpt::comms::CServerTCPSocket::accept(), mrpt::vision::add_3d_deltas_to_points(), mrpt::slam::CIncrementalMapPartitioner::addMapFrame(), mrpt::graphslam::TSlidingWindow::addNewMeasurement(), mrpt::gui::CDisplayWindowPlots::addPopupMenuEntry(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::addScanMatchingEdges(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::addToPaths(), mrpt::slam::CICP::Align3DPDF(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::alignOpticalWithMRPTFrame(), mrpt::slam::CGridMapAligner::AlignPDF(), mrpt::slam::CICP::AlignPDF(), mrpt::slam::CGridMapAligner::AlignPDF_correlation(), mrpt::slam::CGridMapAligner::AlignPDF_robustMatch(), mrpt::poses::CPose3DPDFSOG::appendFrom(), mrpt::hmtslam::CHMTSLAM::areaAbstraction(), mrpt::hmtslam::CHierarchicalMapMHPartition::areNodesNeightbour(), mrpt::obs::CRawlog::asObservation(), mrpt::opengl::CRenderizableShaderTexturedTriangles::assignImage(), mrpt::opengl::CMeshFast::assignImage(), mrpt::opengl::CMesh::assignImage(), mrpt::opengl::CMeshFast::assignImageAndZ(), mrpt::opengl::CMesh::assignImageAndZ(), mrpt::maps::CMultiMetricMap::auxParticleFilterCleanUp(), mrpt::math::averageLogLikelihood(), mrpt::vision::ba_compute_Jacobians(), mrpt::maps::CPointsMap::base_copyFrom(), mrpt::poses::CPoint2DPDFGaussian::bayesianFusion(), mrpt::poses::CPointPDFGaussian::bayesianFusion(), mrpt::poses::CPointPDFParticles::bayesianFusion(), mrpt::poses::CPose3DPDFSOG::bayesianFusion(), mrpt::maps::CBeacon::bayesianFusion(), mrpt::poses::CPosePDFGaussian::bayesianFusion(), mrpt::poses::CPose3DPDFGaussian::bayesianFusion(), mrpt::poses::CPosePDFGaussianInf::bayesianFusion(), mrpt::poses::CPointPDFSOG::bayesianFusion(), mrpt::poses::CPosePDFSOG::bayesianFusion(), mrpt::maps::CPointsMap::boundingBox(), mrpt::nav::CAbstractPTGBasedReactive::calc_move_candidate_scores(), mrpt::hwdrivers::CBoardSonars::CBoardSonars(), mrpt::comms::CClientTCPSocket::CClientTCPSocket(), mrpt::config::CConfigFile::CConfigFile(), mrpt::opengl::CFBORender::CFBORender(), mrpt::io::CFileGZInputStream::CFileGZInputStream(), mrpt::io::CFileGZOutputStream::CFileGZOutputStream(), mrpt::io::CFileInputStream::CFileInputStream(), mrpt::io::CFileOutputStream::CFileOutputStream(), mrpt::system::CFileSystemWatcher::CFileSystemWatcher(), mrpt::hwdrivers::CImageGrabber_dc1394::changeCaptureOptions(), mrpt::img::CMappedImage::changeCoordinates(), mrpt::slam::CIncrementalMapPartitioner::changeCoordinatesOriginPoseIndex(), mrpt::poses::CPose3DQuatPDFGaussianInf::changeCoordinatesReference(), mrpt::maps::CBeacon::changeCoordinatesReference(), mrpt::poses::CPose3DQuatPDFGaussian::changeCoordinatesReference(), mrpt::poses::CPose3DPDFGaussianInf::changeCoordinatesReference(), mrpt::poses::CPose3DPDFGaussian::changeCoordinatesReference(), mrpt::hwdrivers::CRoboPeakLidar::checkCOMMs(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::checkForLoopClosures(), mrpt::detectors::CFaceDetection::checkIfDiagonalSurface(), mrpt::detectors::CFaceDetection::checkIfDiagonalSurface2(), mrpt::detectors::CFaceDetection::checkIfFaceRegions(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkOptimizerExists(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::checkPartitionsForLC(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::checkRegistrationCondition(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::checkRegistrationCondition(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::checkRegistrationCondition(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::checkRegistrationCondition2D(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::checkRegistrationCondition2D(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::checkRegistrationCondition3D(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkRegistrationDeciderExists(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::CICPCriteriaERD(), mrpt::img::CImage::CImage(), mrpt::hwdrivers::CImageGrabber_dc1394::CImageGrabber_dc1394(), mrpt::hwdrivers::CImageGrabber_OpenCV::CImageGrabber_OpenCV(), mrpt::comms::CInterfaceFTDI::CInterfaceFTDI(), mrpt::hmtslam::CPropertiesValuesList::clear(), mrpt::hmtslam::CMHPropertiesValuesList::clear(), mrpt::gui::CDisplayWindowPlots::clear(), mrpt::comms::CSerialPort::close(), mrpt::comms::CClientTCPSocket::close(), mrpt::comms::CInterfaceFTDI::Close(), mrpt::io::CMemoryStream::CMemoryStream(), mrpt::maps::CMultiMetricMap::CMultiMetricMap(), mrpt::hwdrivers::CMyntEyeCamera::CMyntEyeCamera(), mrpt::maps::COccupancyGridMap2D::COccupancyGridMap2D(), mrpt::maps::COccupancyGridMap3D::COccupancyGridMap3D(), mrpt::img::colormap(), mrpt::io::zip::compress(), mrpt::maps::CPointsMap::compute3DDistanceToMesh(), mrpt::maps::CBeaconMap::compute3DMatchingRatio(), mrpt::maps::CMultiMetricMap::compute3DMatchingRatio(), mrpt::maps::CLandmarksMap::compute3DMatchingRatio(), mrpt::maps::CMetricMap::compute3DMatchingRatio(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeCentroidOfNodesVector(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeCoordinatesTransformationBetweenNodes(), mrpt::vision::CFeatureExtraction::computeDescriptors(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeGloballyConsistentNodeCoordinates(), mrpt::poses::CPointPDFParticles::computeKurtosis(), mrpt::maps::CLandmarksMap::computeLikelihood_RSLC_2007(), mrpt::maps::COccupancyGridMap2D::computeLikelihoodField_II(), mrpt::maps::COccupancyGridMap2D::computeLikelihoodField_Thrun(), mrpt::vision::computeMainOrientation(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::maps::CLandmarksMap::computeMatchingWith2D(), mrpt::maps::CBeaconMap::computeMatchingWith3DLandmarks(), mrpt::maps::CLandmarksMap::computeMatchingWith3DLandmarks(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeMatchProbabilityBetweenNodes(), mrpt::maps::COccupancyGridMap2D::computeObservationLikelihood_likelihoodField_II(), mrpt::maps::COccupancyGridMap2D::computeObservationLikelihood_likelihoodField_Thrun(), mrpt::maps::COccupancyGridMap2D::computeObservationLikelihood_MI(), mrpt::slam::CRangeBearingKFSLAM::computeOffDiagonalBlocksApproximationError(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeOverlapProbabilityBetweenNodes(), mrpt::bayes::CParticleFilterCapable::computeResampling(), mrpt::vision::computeSAD(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeSlamMetric(), mrpt::math::confidenceIntervals(), mrpt::comms::CClientTCPSocket::connect(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::convert3DTo2DRangeScan(), mrpt::poses::CPose3DPDFParticles::copyFrom(), mrpt::poses::CPosePDFParticles::copyFrom(), mrpt::poses::CPose3DPDFSOG::copyFrom(), mrpt::maps::CBeacon::copyFrom(), mrpt::poses::CPose3DPDFGaussian::copyFrom(), mrpt::poses::CPointPDFSOG::copyFrom(), mrpt::poses::CPosePDFSOG::copyFrom(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::createDeciderOptimizerMappings(), mrpt::poses::CPose3DPDF::createFrom2D(), mrpt::poses::CPose3DQuatPDF::createFrom2D(), mrpt::nav::CParameterizedTrajectoryGenerator::CreatePTG(), mrpt::opengl::COpenGLScene::createViewport(), mrpt::gui::CBaseGUIWindow::createWxWindow(), mrpt::hwdrivers::CRoboticHeadInterface::CRoboticHeadInterface(), mrpt::math::cross_correlation_FFT(), mrpt::img::CImage::cross_correlation_FFT(), mrpt::hwdrivers::CSickLaserUSB::CSickLaserUSB(), mrpt::slam::data_association_full_covariance(), mrpt::slam::data_association_independent_predictions(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::decimateLaserScan(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::decimatePointsMap(), mrpt::io::zip::decompress(), mrpt::system::deleteFiles(), mrpt::maps::CHeightGridMap2D_Base::dem_internal_insertObservation(), mrpt::vision::CFeature::descriptorDistanceTo(), mrpt::vision::CFeature::descriptorLogPolarImgDistanceTo(), mrpt::vision::CFeature::descriptorPolarImgDistanceTo(), mrpt::serialization::CMessage::deserializeIntoExistingObject(), mrpt::serialization::CMessage::deserializeIntoNewObject(), mrpt::gui::CBaseGUIWindow::destroyWxWindow(), mrpt::detectors::CFaceDetection::detectObjects_Impl(), mrpt::maps::CMultiMetricMap::determineMatching2D(), mrpt::maps::CMetricMap::determineMatching2D(), mrpt::maps::CBeaconMap::determineMatching2D(), mrpt::maps::COccupancyGridMap3D::determineMatching2D(), mrpt::maps::CPointsMap::determineMatching2D(), mrpt::maps::COccupancyGridMap2D::determineMatching2D(), mrpt::maps::CMetricMap::determineMatching3D(), mrpt::maps::CPointsMap::determineMatching3D(), mrpt::math::dft2_complex(), mrpt::math::dft2_real(), do_rectify(), mrpt::poses::CPoseRandomSampler::do_sample_2D(), mrpt::poses::CPoseRandomSampler::do_sample_3D(), mrpt::slam::CMetricMapBuilderRBPF::drawCurrentEstimationToImage(), mrpt::img::CCanvas::drawImage(), mrpt::poses::CPose3DQuatPDFGaussianInf::drawManySamples(), mrpt::poses::CPose3DQuatPDFGaussian::drawManySamples(), mrpt::poses::CPose3DPDFGaussianInf::drawManySamples(), mrpt::poses::CPosePDFGaussian::drawManySamples(), mrpt::poses::CPose3DPDFGaussian::drawManySamples(), mrpt::poses::CPosePDFGaussianInf::drawManySamples(), mrpt::poses::CPosePDFSOG::drawManySamples(), mrpt::poses::CPoseRandomSampler::drawSample(), mrpt::poses::CPoint2DPDFGaussian::drawSingleSample(), mrpt::poses::CPose3DQuatPDFGaussianInf::drawSingleSample(), mrpt::poses::CPose3DQuatPDFGaussian::drawSingleSample(), mrpt::maps::CBeacon::drawSingleSample(), mrpt::poses::CPose3DPDFGaussianInf::drawSingleSample(), mrpt::poses::CPosePDFGaussian::drawSingleSample(), mrpt::poses::CPointPDFGaussian::drawSingleSample(), mrpt::poses::CPose3DPDFGaussian::drawSingleSample(), mrpt::poses::CPosePDFGaussianInf::drawSingleSample(), mrpt::poses::CPointPDFSOG::drawSingleSample(), mrpt::poses::CPosePDFSOG::drawSingleSample(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpOptimizersToConsole(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpRegistrarsToConsole(), mrpt::graphslam::TSlidingWindow::dumpToTextStream(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::dumpToTextStream(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::dumpToTextStream(), mrpt::maps::TSetOfMetricMapInitializers::dumpToTextStream(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLaserParams::dumpToTextStream(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLoopClosureParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::dumpVisibilityErrorMsg(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::dumpVisibilityErrorMsg(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::dumpVisibilityErrorMsg(), mrpt::img::CEnhancedMetaFile::ellipseGaussian(), mrpt::img::CCanvas::ellipseGaussian(), mrpt::poses::CPointPDFSOG::enforceCovSymmetry(), mrpt::poses::CPose3DPDFSOG::enforceCovSymmetry(), mrpt::hwdrivers::CHokuyoURG::ensureStreamIsOpen(), mrpt::hwdrivers::CImageGrabber_dc1394::enumerateCameras(), mrpt::obs::CActionCollection::erase(), mrpt::obs::CSensoryFrame::erase(), mrpt::obs::CSensoryFrame::eraseByIndex(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::ESS(), mrpt::poses::CPointPDFSOG::ESS(), mrpt::math::estimateJacobian(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evalPWConsistenciesMatrix(), mrpt::graphslam::TSlidingWindow::evaluateMeasurementAbove(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evaluatePartitionsForLC(), mrpt::poses::CPointPDFSOG::evaluatePDFInArea(), mrpt::poses::CPosePDFSOG::evaluatePDFInArea(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::execDijkstraProjection(), mrpt::math::RANSAC_Template< NUMTYPE, DATASET, MODEL >::execute(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::bayes::CParticleFilter::executeOn(), mrpt::system::CDirectoryExplorer::explore(), mrpt::system::extractDayTimeFromTimestamp(), mrpt::vision::CFeatureExtraction::extractFeaturesAKAZE(), mrpt::vision::CFeatureExtraction::extractFeaturesFAST(), mrpt::vision::CFeatureExtraction::extractFeaturesKLT(), mrpt::vision::CFeatureExtraction::extractFeaturesLSD(), mrpt::vision::CFeatureExtraction::extractFeaturesORB(), mrpt::bayes::CParticleFilterCapable::fastDrawSample(), mrpt::math::fft_real(), mrpt::maps::CPointCloudFilterByDistance::filter(), mrpt::obs::CObservation2DRangeScan::filterByExclusionAngles(), mrpt::obs::CObservation2DRangeScan::filterByExclusionAreas(), mrpt::vision::find_descriptor_pairings(), mrpt::hmtslam::CHierarchicalMapMHPartition::findArcOfTypeBetweenNodes(), mrpt::hmtslam::CHierarchicalMapMHPartition::findArcsBetweenNodes(), mrpt::hmtslam::CHierarchicalMapMHPartition::findArcsOfTypeBetweenNodes(), mrpt::vision::findChessboardCorners(), mrpt::obs::CRawlog::findObservationsByClassInRange(), mrpt::hmtslam::CHierarchicalMapMHPartition::findPathBetweenNodes(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::fitGraphInView(), mrpt::maps::COccupancyGridMap2D::freeMap(), mrpt::obs::CObservationRotatingScan::fromGeneric(), mrpt::obs::CObservationRotatingScan::fromPointCloud(), mrpt::math::CQuaternion< T >::fromRodriguesVector(), mrpt::ros1bridge::fromROS(), mrpt::obs::CObservationRotatingScan::fromScan2D(), mrpt::math::CVectorDynamic< KFTYPE >::fromVectorLike(), mrpt::obs::CObservationRotatingScan::fromVelodyne(), mrpt::comms::CInterfaceFTDI::ftdi_getQueueStatus(), mrpt::comms::CInterfaceFTDI::ftdi_listDevices(), mrpt::comms::CInterfaceFTDI::ftdi_open(), mrpt::comms::CInterfaceFTDI::ftdi_openEx(), mrpt::comms::CInterfaceFTDI::ftdi_read(), mrpt::comms::CInterfaceFTDI::ftdi_write(), mrpt::maps::CLandmarksMap::fuseWith(), mrpt::math::generateAxisBaseFromDirection(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generateHypotsPool(), mrpt::hmtslam::CHMTSLAM::generateLogFiles(), mrpt::maps::CBeacon::generateObservationModelDistribution(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistenciesMatrix(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistencyElement(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::generateReportFiles(), mrpt::maps::CBeacon::generateRingSOG(), mrpt::obs::CActionCollection::getActionByClass(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::hmtslam::CMHPropertiesValuesList::getAs(), mrpt::maps::CWirelessPowerGridMap2D::getAs3DObject(), mrpt::maps::CHeightGridMap2D_MRF::getAs3DObject(), mrpt::maps::CGasConcentrationGridMap2D::getAs3DObject(), mrpt::maps::CReflectivityGridMap2D::getAs3DObject(), mrpt::maps::CBeacon::getAs3DObject(), mrpt::maps::CMultiMetricMap::getAs3DObject(), mrpt::maps::CBeaconMap::getAs3DObject(), mrpt::maps::CPointsMap::getAs3DObject(), mrpt::maps::COccupancyGridMap2D::getAs3DObject(), mrpt::hmtslam::CHierarchicalMapMHPartition::getAs3DScene(), mrpt::obs::CRawlog::getAsAction(), mrpt::maps::CRandomFieldGridMap2D::getAsBitmapFile(), mrpt::obs::CRawlog::getAsGeneric(), mrpt::maps::CBeacon::getAsMatlabDrawCommands(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::maps::CRandomFieldGridMap2D::getAsMatrix(), mrpt::poses::CPose3DGridTemplate< double >::getAsMatrix(), mrpt::img::CImage::getAsMatrix(), mrpt::img::CImage::getAsMatrixTiled(), mrpt::obs::CRawlog::getAsObservation(), mrpt::obs::CRawlog::getAsObservations(), mrpt::maps::COccupancyGridMap3D::getAsOctoMapVoxels(), mrpt::img::CImage::getAsRGBMatrices(), mrpt::maps::CMultiMetricMap::getAsSimplePointsMap(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::TParams::getAsString(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::getAsString(), mrpt::vision::CMatchedFeatureList::getBothFeatureLists(), mrpt::poses::CPoseInterpolatorBase< 3 >::getBoundingBox(), mrpt::opengl::CSetOfObjects::getByClass(), mrpt::opengl::COpenGLScene::getByClass(), mrpt::opengl::COpenGLViewport::getByClass(), mrpt::opengl::CFBORender::getCamera(), mrpt::serialization::CMessage::getContentAsStruct(), mrpt::config::CConfigFileBase::getContentAsYAML(), mrpt::poses::CPointPDFParticles::getCovarianceAndMean(), mrpt::poses::CPose3DPDFParticles::getCovarianceAndMean(), mrpt::maps::CBeacon::getCovarianceAndMean(), mrpt::slam::CRangeBearingKFSLAM2D::getCurrentRobotPose(), mrpt::slam::CRangeBearingKFSLAM::getCurrentRobotPose(), mrpt::slam::CRangeBearingKFSLAM2D::getCurrentState(), mrpt::slam::CRangeBearingKFSLAM::getCurrentState(), mrpt::system::getcwd(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::getDescriptiveReport(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getDescriptiveReport(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::getEdgesStats(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getEdgesStats(), mrpt::hmtslam::CMHPropertiesValuesList::getElemental(), mrpt::opengl::CFBORender::getFrame(), mrpt::opengl::CFBORender::getFrame2(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getGraphSlamStats(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::getICPEdge(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getICPEdge(), mrpt::hwdrivers::CJoystick::getJoystickPosition(), mrpt::hwdrivers::CJoystick::getJoysticksCount(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap(), mrpt::vision::CFeatureList::getMaxID(), mrpt::vision::CMatchedFeatureList::getMaxID(), mrpt::poses::CPointPDFParticles::getMean(), mrpt::graphslam::TSlidingWindow::getMean(), mrpt::poses::CPose3DPDFParticles::getMean(), mrpt::maps::CBeacon::getMean(), mrpt::hmtslam::CLocalMetricHypothesis::getMeans(), mrpt::graphslam::TSlidingWindow::getMedian(), mrpt::system::getMemoryUsage(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getMinUncertaintyPath(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getMostLikelyParticle(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::getNearbyNodesOf(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::getNearbyNodesOf(), mrpt::opengl::CRenderizableShaderTexturedTriangles::getNewTextureNumber(), mrpt::hmtslam::CHierarchicalMapMHPartition::getNodeByID(), mrpt::hmtslam::CHierarchicalMapMHPartition::getNodeByLabel(), mrpt::hwdrivers::CImageGrabber_OpenCV::getObservation(), mrpt::hwdrivers::CImageGrabber_dc1394::getObservation(), mrpt::obs::CSensoryFrame::getObservationByClass(), mrpt::obs::CSensoryFrame::getObservationByIndex(), mrpt::obs::CSensoryFrame::getObservationBySensorLabel(), mrpt::poses::CPoseRandomSampler::getOriginalPDFCov2D(), mrpt::poses::CPoseRandomSampler::getOriginalPDFCov3D(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getParamsAsString(), mrpt::hmtslam::CLocalMetricHypothesis::getPathParticles(), mrpt::img::CImage::getPixelDepth(), mrpt::hmtslam::CLocalMetricHypothesis::getPoseParticles(), mrpt::comms::CClientTCPSocket::getPosition(), mrpt::comms::CSerialPort::getPosition(), mrpt::hmtslam::CLocalMetricHypothesis::getRelativePose(), mrpt::poses::CPoseRandomSampler::getSamplingMean2D(), mrpt::poses::CPoseRandomSampler::getSamplingMean3D(), mrpt::graphslam::TSlidingWindow::getStdDev(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getTimeStamp(), mrpt::comms::CClientTCPSocket::getTotalBytesCount(), mrpt::comms::CSerialPort::getTotalBytesCount(), mrpt::obs::CRawlog::getType(), mrpt::opengl::COpenGLScene::getViewport(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getWeights(), mrpt::graphs::detail::graph_ops< graph_t >::graph_edge_sqerror(), mrpt::graphs::detail::graph_ops< graph_t >::graph_of_poses_collapse_dup_edges(), mrpt::graphs::detail::graph_ops< graph_t >::graph_of_poses_dijkstra_init(), mrpt::maps::CLandmarksMap::TCustomSequenceLandmarks::hasBeenModifiedAll(), mrpt::math::homogeneousMatrixInverse(), mrpt::slam::CICP::ICP3D_Method_Classic(), mrpt::slam::CICP::ICP_Method_Classic(), mrpt::slam::CICP::ICP_Method_LM(), mrpt::math::idft2_complex(), mrpt::math::idft2_real(), mrpt::gui::CDisplayWindowPlots::image(), mrpt::apps::DataSourceRawlog::impl_get_next_observations(), mrpt::apps::ICP_SLAM_App_Live::impl_get_next_observations(), mrpt::apps::ICP_SLAM_App_Rawlog::impl_initialize(), mrpt::apps::RBPF_SLAM_App_Rawlog::impl_initialize(), mrpt::apps::ICP_SLAM_App_Live::impl_initialize(), mrpt::apps::MonteCarloLocalization_Rawlog::impl_initialize(), mrpt::nav::CAbstractPTGBasedReactive::impl_waypoint_is_reachable(), IMPLEMENTS_SERIALIZABLE(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initClass(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::initCurrCovarianceVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initCurrPosViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initEstimatedTrajectoryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::initGraphVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initGTVisualization(), mrpt::apps::CGridMapAlignerApp::initialize(), mrpt::apps::KFSLAMApp::initialize(), mrpt::apps::RawlogGrabberApp::initialize(), mrpt::apps::ICP_SLAM_App_Base::initialize(), mrpt::apps::MonteCarloLocalization_Base::initialize(), mrpt::apps::RBPF_SLAM_App_Base::initialize(), mrpt::slam::CMetricMapBuilderICP::initialize(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::initializeVisuals(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::initializeVisuals(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::initializeVisuals(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initIntensityImageViewport(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::initLaserScansVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initOdometryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::initOptDistanceVisualization(), CGraphSlamHandler< GRAPH_T >::initOutputDir(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initRangeImageViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initResultsFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initSlamMetricVisualization(), mrpt::opengl::COpenGLScene::insert(), mrpt::maps::CSimpleMap::insert(), mrpt::maps::CRandomFieldGridMap3D::insertIndividualReading(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KernelDM_DMV(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KF(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KF2(), mrpt::maps::CMetricMap::insertObservationPtr(), mrpt::maps::COccupancyGridMap3D::insertPointCloud(), mrpt::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >::insertPointCloud(), mrpt::maps::COccupancyGridMap3D::insertRay(), mrpt::maps::CSimpleMap::insertToPos(), mrpt::vision::CFeatureExtraction::internal_computeLATCHDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeLogPolarImageDescriptors(), mrpt::maps::CBeaconMap::internal_computeObservationLikelihood(), mrpt::maps::CReflectivityGridMap2D::internal_computeObservationLikelihood(), mrpt::maps::CLandmarksMap::internal_computeObservationLikelihood(), mrpt::maps::CMultiMetricMap::internal_computeObservationLikelihood(), mrpt::vision::CFeatureExtraction::internal_computePolarImageDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeSpinImageDescriptors(), mrpt::vision::CFeature::internal_distanceBetweenPolarImages(), mrpt::img::CImage::internal_fromIPL(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::internal_initialize(), mrpt::maps::CBeaconMap::internal_insertObservation(), mrpt::maps::COccupancyGridMap3D::internal_insertObservation(), mrpt::maps::CWirelessPowerGridMap2D::internal_insertObservation(), mrpt::maps::CLandmarksMap::internal_insertObservation(), mrpt::maps::CReflectivityGridMap2D::internal_insertObservation(), mrpt::maps::CGasConcentrationGridMap2D::internal_insertObservation(), mrpt::maps::CPointsMap::internal_insertObservation(), mrpt::maps::COccupancyGridMap3D::internal_insertObservationScan2D(), mrpt::maps::COccupancyGridMap3D::internal_insertObservationScan3D(), mrpt::system::CObservable::internal_observer_end(), mrpt::gui::CDisplayWindowPlots::internal_plot(), mrpt::hwdrivers::CVelodyneScanner::internal_send_http_post(), mrpt::math::interpolate(), mrpt::math::interpolate2points(), mrpt::maps::CHeightGridMap2D_Base::intersectLine3D(), mrpt::poses::CPose3DPDFParticles::inverse(), mrpt::poses::CPose3DPDFSOG::inverse(), mrpt::poses::CPosePDFParticles::inverse(), mrpt::opengl::CFBORender::isExtensionSupported(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeClosestPoint2D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeClosestPoint3D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint2D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint2DIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3DIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3DWithIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeRadiusSearch2D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeRadiusSearch3D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeTwoClosestPoint2D(), mrpt::math::KLD_Gaussians(), mrpt::maps::COccupancyGridMap2D::laserScanSimulator(), mrpt::math::leastSquareLinearFit(), mrpt::comms::CInterfaceFTDI::ListAllDevices(), mrpt::obs::CObservationPointCloud::load(), mrpt::maps::CPointsMap::load2Dor3D_from_text_file(), mrpt::hwdrivers::CGenericSensor::loadConfig(), mrpt::hwdrivers::CWirelessPower::loadConfig_sensorSpecific(), mrpt::hwdrivers::CImpinjRFID::loadConfig_sensorSpecific(), mrpt::hwdrivers::CEnoseModular::loadConfig_sensorSpecific(), mrpt::hwdrivers::CBoardENoses::loadConfig_sensorSpecific(), mrpt::hwdrivers::CBoardSonars::loadConfig_sensorSpecific(), mrpt::hwdrivers::CVelodyneScanner::loadConfig_sensorSpecific(), mrpt::nav::CReactiveNavigationSystem::loadConfigFile(), mrpt::nav::CReactiveNavigationSystem3D::loadConfigFile(), mrpt::nav::CWaypointsNavigator::loadConfigFile(), mrpt::nav::CAbstractNavigator::loadConfigFile(), mrpt::nav::CAbstractPTGBasedReactive::loadConfigFile(), mrpt::opengl::COpenGLViewport::loadDefaultShaders(), mrpt::comms::CInterfaceFTDI::loadDriver(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::loadFromArray(), mrpt::maps::COccupancyGridMap2D::loadFromBitmap(), mrpt::maps::COccupancyGridMap2D::loadFromBitmapFile(), mrpt::slam::CIncrementalMapPartitioner::TOptions::loadFromConfigFile(), mrpt::nav::CHolonomicVFF::TOptions::loadFromConfigFile(), mrpt::graphslam::TSlidingWindow::loadFromConfigFile(), mrpt::slam::CMetricMapBuilderRBPF::TConstructionOptions::loadFromConfigFile(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::nav::CHolonomicND::TOptions::loadFromConfigFile(), mrpt::bayes::CParticleFilter::TParticleFilterOptions::loadFromConfigFile(), mrpt::nav::CHolonomicFullEval::TOptions::loadFromConfigFile(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::loadFromConfigFile(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::loadFromConfigFile(), mrpt::nav::CAbstractPTGBasedReactive::TAbstractPTGNavigatorParams::loadFromConfigFile(), mrpt::maps::TSetOfMetricMapInitializers::loadFromConfigFile(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLaserParams::loadFromConfigFile(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLoopClosureParams::loadFromConfigFile(), mrpt::img::CImage::loadFromFile(), mrpt::img::CImage::loadFromMemoryBuffer(), mrpt::opengl::CPointCloud::loadFromPointsList(), mrpt::img::CImage::loadFromStreamAsJPEG(), mrpt::poses::CPoseInterpolatorBase< 3 >::loadFromTextFile(), mrpt::vision::TSequenceFeatureObservations::loadFromTextFile(), mrpt::vision::CFeatureList::loadFromTextFile(), mrpt::graphslam::deciders::CRangeScanEdgeRegistrationDecider< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::loadParams(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::loadParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::loadParams(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::loadParams(), mrpt::maps::CLandmarksMap::loadSiftFeaturesFromStereoImageObservation(), mrpt::maps::CPointsMapXYZI::loadXYZI_from_text_file(), mrpt::bayes::CParticleFilterCapable::log2linearWeights(), mrpt::hmtslam::CHMTSLAM::loopClosureDetector_factory(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_AA(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_TBI(), mrpt::math::mahalanobisDistance2(), mrpt::math::mahalanobisDistance2AndLogPDF(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::mahalanobisDistanceOdometryToICPEdge(), mrpt::poses::CPose3DQuatPDFGaussian::mahalanobisDistanceTo(), mrpt::poses::CPosePDFGaussian::mahalanobisDistanceTo(), mrpt::poses::CPosePDFGaussianInf::mahalanobisDistanceTo(), mrpt::poses::CPose3DPDFGaussianInf::mahalanobisDistanceTo(), mrpt::poses::CPose3DPDFGaussian::mahalanobisDistanceTo(), mrpt::maps::CMultiMetricMap::mapByIndex(), mrpt::vision::matchFeatures(), mrpt::math::MATLAB_plotCovariance2D(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::poses::CPosePDFSOG::mergeModes(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::math::multiply_A_skew3(), mrpt::math::multiply_skew3_A(), mrpt::nav::CAbstractNavigator::navigate(), mrpt::nav::CWaypointsNavigator::navigateWaypoints(), mrpt::nav::CWaypointsNavigator::navigationStep(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::normalizeWeights(), mrpt::poses::CPose3DPDFSOG::normalizeWeights(), mrpt::poses::CPointPDFSOG::normalizeWeights(), mrpt::poses::CPosePDFSOG::normalizeWeights(), mrpt::math::normalPDF(), mrpt::math::normalPDFInf(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::notifyOfWindowEvents(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::notifyOfWindowEvents(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::notifyOfWindowEvents(), mrpt::hmtslam::CHMHMapNode::onArcAddition(), mrpt::hmtslam::CHMHMapNode::onArcDestruction(), mrpt::slam::CRangeBearingKFSLAM2D::OnGetObservationsAndDataAssociation(), mrpt::slam::CRangeBearingKFSLAM::OnGetObservationsAndDataAssociation(), mrpt::slam::CRangeBearingKFSLAM2D::OnInverseObservationModel(), mrpt::slam::CRangeBearingKFSLAM::OnInverseObservationModel(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnNewLandmarkAddedToMap(), mrpt::slam::CRangeBearingKFSLAM::OnNewLandmarkAddedToMap(), mrpt::hmtslam::CHMHMapArc::onNodeDestruction(), mrpt::slam::CRangeBearingKFSLAM::OnNormalizeStateVector(), mrpt::slam::CRangeBearingKFSLAM2D::OnObservationJacobians(), mrpt::slam::CRangeBearingKFSLAM::OnObservationJacobians(), mrpt::slam::CRangeBearingKFSLAM2D::OnObservationModel(), mrpt::slam::CRangeBearingKFSLAM::OnObservationModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionJacobian(), mrpt::slam::CRangeBearingKFSLAM::OnTransitionJacobian(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionModel(), mrpt::slam::CRangeBearingKFSLAM::OnTransitionModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionNoise(), mrpt::slam::CRangeBearingKFSLAM::OnTransitionNoise(), mrpt::opengl::CTexturedPlane::onUpdateBuffers_TexturedTriangles(), mrpt::io::CFileGZInputStream::open(), mrpt::io::CFileGZOutputStream::open(), mrpt::comms::CSerialPort::open(), mrpt::comms::CInterfaceFTDI::OpenByDescription(), mrpt::comms::CInterfaceFTDI::OpenBySerialNumber(), mrpt::vision::openCV_cross_correlation(), mrpt::img::CImage::operator()(), mrpt::maps::CSimpleMap::operator=(), mrpt::obs::CSensoryFrame::operator=(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::operator=(), mrpt::math::CVectorDynamic< KFTYPE >::operator=(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator=(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::optimizeGraph(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::particlesEvaluator_AuxPFOptimal(), mrpt::vision::CFeature::patchCorrelationTo(), mrpt::topography::path_from_rtk_gps(), mrpt::hmtslam::CHMTSLAM::perform_TLC(), mrpt::bayes::CParticleFilterCapable::performResampling(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::performSubstitution(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfStandardProposal(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::gui::CDisplayWindow::plot(), mrpt::gui::CDisplayWindowPlots::plotEllipse(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::popMinUncertaintyPath(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::populateDeciderOptimizerProperties(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfOptimalProposal(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::prediction_and_update_pfOptimalProposal(), mrpt::slam::CMonteCarloLocalization3D::prediction_and_update_pfStandardProposal(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfStandardProposal(), mrpt::slam::CMonteCarloLocalization2D::prediction_and_update_pfStandardProposal(), mrpt::maps::CRandomFieldGridMap2D::predictMeasurement(), mrpt::bayes::CParticleFilterCapable::prepareFastDrawSample(), mrpt::obs::CActionRobotMovement2D::prepareFastDrawSingleSample_modelGaussian(), mrpt::io::CStream::printf(), mrpt::graphslam::deciders::CRangeScanEdgeRegistrationDecider< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::printParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::printParams(), mrpt::detectors::CDetectorDoorCrossing::process(), mrpt::slam::CRangeBearingKFSLAM2D::processActionObservation(), mrpt::slam::CRangeBearingKFSLAM::processActionObservation(), mrpt::slam::CMetricMapBuilderRBPF::processActionObservation(), mrpt::nav::CAbstractNavigator::processNavigateCommand(), mrpt::slam::CMetricMapBuilderICP::processObservation(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::processOneLMH(), mrpt::poses::CRobot2DPoseEstimator::processUpdateNewOdometry(), mrpt::poses::CPoint2DPDFGaussian::productIntegralWith(), mrpt::poses::CPointPDFGaussian::productIntegralWith(), mrpt::poses::CPointPDFGaussian::productIntegralWith2D(), mrpt::vision::projectMatchedFeatures(), mrpt::vision::pinhole::projectPoints_no_distortion(), mrpt::vision::pinhole::projectPoints_with_distortion(), mrpt::system::CObservable::publishEvent(), mrpt::comms::CInterfaceFTDI::Purge(), mrpt::comms::CSerialPort::purgeBuffers(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::queryObserverForEvents(), mrpt::math::ransac_detect_2D_lines(), mrpt::comms::CClientTCPSocket::Read(), mrpt::comms::CSerialPort::Read(), mrpt::config::CConfigFileBase::read_enum(), mrpt::comms::CClientTCPSocket::readAsync(), mrpt::gui::CPanelCameraSelection::readConfigIntoVideoSourcePanel(), mrpt::hwdrivers::readConfigIntoVideoSourcePanel(), readFileWithPoses(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFileRGBD_TUM(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::readParticlesFromStream(), mrpt::config::CConfigFile::readString(), mrpt::config::CConfigFileMemory::readString(), mrpt::maps::CMultiMetricMapPDF::rebuildAverageMap(), mrpt::serialization::CArchive::receiveMessage(), mrpt::obs::CObservation3DRangeScan::recoverCameraCalibrationParameters(), mrpt::vision::CStereoRectifyMap::rectify(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::registerNewEdge(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::registerNewNodeAtEnd(), mrpt::bayes::CRejectionSamplingCapable< CPose2D >::rejectionSampling(), mrpt::opengl::CRenderizableShaderTexturedTriangles::releaseTextureName(), mrpt::maps::CSimpleMap::remove(), mrpt::obs::CRawlog::remove(), mrpt::hmtslam::CLocalMetricHypothesis::removeAreaFromLMH(), mrpt::vision::TSequenceFeatureObservations::removeFewObservedFeatures(), mrpt::opengl::COpenGLScene::removeObject(), mrpt::slam::CIncrementalMapPartitioner::removeSetOfNodes(), mrpt::opengl::COpenGLScene::render(), mrpt::opengl::COpenGLViewport::render(), mrpt::opengl::COpenGLViewport::renderNormalSceneMode(), mrpt::opengl::COpenGLViewport::renderTextMessages(), mrpt::opengl::COpenGLViewport::renderViewportBorder(), mrpt::vision::reprojectionResiduals(), mrpt::poses::CPosePDFParticles::resetAroundSetOfPoses(), mrpt::comms::CInterfaceFTDI::ResetDevice(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::resetPDF(), mrpt::poses::CPose3DPDFParticles::resetUniform(), mrpt::poses::CPosePDFParticles::resetUniform(), mrpt::slam::CMonteCarloLocalization2D::resetUniformFreeSpace(), mrpt::opengl::CFBORender::resize(), mrpt::maps::CRandomFieldGridMap3D::resize(), mrpt::img::CImage::resize(), mrpt::maps::CRandomFieldGridMap2D::resize(), mrpt::maps::COccupancyGridMap3D::resizeGrid(), mrpt::graphslam::TSlidingWindow::resizeWindow(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::RS_drawFromProposal(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::RS_observationLikelihood(), mrpt::apps::CGridMapAlignerApp::run(), mrpt::apps::KFSLAMApp::run(), mrpt::apps::RawlogGrabberApp::run(), MapExecutor::run(), mrpt::apps::MonteCarloLocalization_Base::run(), mrpt::apps::RBPF_SLAM_App_Base::run(), mrpt::apps::ICP_SLAM_App_Base::run(), mrpt::apps::KFSLAMApp::Run_KF_SLAM(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::save3DScene(), mrpt::maps::CRandomFieldGridMap2D::saveAsBitmapFile(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFile(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapTwoMapsWithCorrespondences(), mrpt::maps::COccupancyGridMap2D::saveAsEMFTwoMapsWithCorrespondences(), mrpt::maps::CRandomFieldGridMap2D::saveAsMatlab3DGraph(), mrpt::vision::TSequenceFeatureObservations::saveAsSBAFiles(), mrpt::slam::CMetricMapBuilderICP::saveCurrentEstimationToImage(), mrpt::slam::CMetricMapBuilderRBPF::saveCurrentEstimationToImage(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::saveGraph(), mrpt::maps::CMultiMetricMap::saveMetricMapRepresentationToFile(), mrpt::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >::saveMetricMapRepresentationToFile(), mrpt::maps::CBeaconMap::saveMetricMapRepresentationToFile(), mrpt::maps::CLandmarksMap::saveMetricMapRepresentationToFile(), mrpt::nav::CPTG_DiffDrive_CCS::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_CC::saveToConfigFile(), mrpt::nav::CPTG_Holo_Blend::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_CS::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_alpha::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_C::saveToConfigFile(), mrpt::nav::CHolonomicVFF::TOptions::saveToConfigFile(), mrpt::nav::CHolonomicND::TOptions::saveToConfigFile(), mrpt::nav::CHolonomicFullEval::TOptions::saveToConfigFile(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::saveToConfigFile(), mrpt::nav::CParameterizedTrajectoryGenerator::saveToConfigFile(), mrpt::img::CImage::saveToFile(), mrpt::img::CImage::saveToStreamAsJPEG(), mrpt::poses::CPoint2DPDFGaussian::saveToTextFile(), mrpt::poses::CPointPDFGaussian::saveToTextFile(), mrpt::poses::CPointPDFParticles::saveToTextFile(), mrpt::maps::CBeacon::saveToTextFile(), mrpt::vision::TSequenceFeatureObservations::saveToTextFile(), mrpt::vision::CFeature::saveToTextFile(), mrpt::vision::CFeatureList::saveToTextFile(), mrpt::maps::CBeaconMap::saveToTextFile(), mrpt::maps::CLandmarksMap::saveToTextFile(), mrpt::tfest::se2_l2(), mrpt::tfest::se2_l2_robust(), se3_l2_internal(), mrpt::tfest::se3_l2_robust(), mrpt::comms::CClientTCPSocket::Seek(), mrpt::comms::CSerialPort::Seek(), mrpt::hwdrivers::CHokuyoURG::sendCmd(), mrpt::serialization::CArchive::sendMessage(), mrpt::obs::CSensoryFrame::serializeFrom(), mrpt::serialization::CMessage::serializeObject(), mrpt::hmtslam::CPropertiesValuesList::set(), mrpt::maps::CSimpleMap::set(), mrpt::hmtslam::CMHPropertiesValuesList::set(), mrpt::obs::CObservationPointCloud::setAsExternalStorage(), mrpt::opengl::CFBORender::setCamera(), mrpt::comms::CSerialPort::setConfig(), mrpt::config::CConfigFileBase::setContentFromYAML(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::setCovMatrixAndMean(), mrpt::hmtslam::CMHPropertiesValuesList::setElemental(), mrpt::config::CConfigFile::setFileName(), mrpt::hwdrivers::CVelodyneScanner::setFramePublishing(), mrpt::vision::CUndistortMap::setFromCamParams(), mrpt::vision::CStereoRectifyMap::setFromCamParams(), mrpt::img::CImage::setFromMatrix(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::setFromMatrixLike(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::setFromMatrixLike(), mrpt::img::CImage::setFromRGBMatrices(), mrpt::hwdrivers::CGPSInterface::setJAVAD_AIM_mode(), mrpt::comms::CInterfaceFTDI::SetLatencyTimer(), mrpt::hwdrivers::CVelodyneScanner::setLidarOnOff(), mrpt::hwdrivers::CVelodyneScanner::setLidarReturnType(), mrpt::hwdrivers::CVelodyneScanner::setLidarRPM(), mrpt::opengl::CSetOfLines::setLineByIndex(), mrpt::maps::CMultiMetricMap::setListOfMaps(), mrpt::hmtslam::CMHPropertiesValuesList::setMemoryReference(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::setObjectPropsFromNodeID(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::setParams(), mrpt::img::CImage::setPixel(), mrpt::poses::CPoseRandomSampler::setPosePDF(), mrpt::maps::COccupancyGridMap3D::setSize(), mrpt::maps::CRandomFieldGridMap3D::setSize(), mrpt::maps::COccupancyGridMap2D::setSize(), mrpt::hwdrivers::CImageGrabber_dc1394::setSoftwareTriggerLevel(), mrpt::comms::CSerialPort::setTimeouts(), mrpt::comms::CInterfaceFTDI::SetTimeouts(), mrpt::comms::CServerTCPSocket::setupSocket(), mrpt::opengl::COpenGLViewport::setViewportPosition(), mrpt::graphslam::detail::CEdgeCounter::setWindowManagerPtr(), mrpt::math::CSplineInterpolator1D::setXY(), mrpt::gui::CDisplayWindow::showImage(), mrpt::gui::CDisplayWindow::showImageAndPoints(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::gui::CDisplayWindow::showTiledImageAndPoints(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::maps::CMetricMap::squareDistanceToClosestCorrespondence(), mrpt::math::detail::stub_kmeans(), mrpt::hmtslam::CHMTSLAM::TBI_main_method(), test_except_2nd_lvl(), test_except_3rd_lvl(), test_except_toplevel(), mrpt::img::CCanvas::textOut(), mrpt::system::timeDifference(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleEstimatedTrajectoryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::toggleGraphVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleGTVisualization(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::toggleLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::toggleLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::toggleMapPartitionsVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleMapVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::toggleOdometryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::toggleOptDistanceVisualization(), mrpt::vision::CFeatureTracker_KL::trackFeatures_impl_templ(), mrpt::math::transform_gaussian_linear(), mrpt::math::transform_gaussian_montecarlo(), mrpt::math::transform_gaussian_unscented(), mrpt::hwdrivers::CHokuyoURG::turnOn(), mrpt::slam::COccupancyGridMapFeatureExtractor::uncached_extractFeatures(), mrpt::vision::CUndistortMap::undistort(), mrpt::vision::pinhole::undistort_point(), mrpt::vision::pinhole::undistort_points(), mrpt::obs::CObservationPointCloud::unload(), mrpt::hwdrivers::CGPSInterface::unsetJAVAD_AIM_mode(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateAllVisuals(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateCurrCovarianceVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateCurrPosViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateEstimatedTrajectoryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateGraphVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateGTVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateIntensityImageViewport(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateMapPartitions(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateMapVisualization(), mrpt::vision::CMatchedFeatureList::updateMaxID(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateOdometryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateOptDistanceVisualization(), mrpt::slam::CIncrementalMapPartitioner::updatePartitions(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateRangeImageViewport(), mrpt::maps::CMultiMetricMapPDF::updateSensoryFrameSequence(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateSlamMetricVisualization(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::updateState(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::updateState2D(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::updateVisuals(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateVisuals(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateVisuals(), mrpt::opengl::COpenGLScene::visitAllObjects(), mrpt::nav::CWaypointsNavigator::waypoints_navigationStep(), mrpt::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), mrpt::comms::CClientTCPSocket::Write(), mrpt::comms::CSerialPort::Write(), mrpt::comms::CClientTCPSocket::writeAsync(), mrpt::gui::CPanelCameraSelection::writeConfigFromVideoSourcePanel(), mrpt::hwdrivers::writeConfigFromVideoSourcePanel(), mrpt::config::CConfigFile::writeNow(), mrpt::serialization::CArchive::WriteObject(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::writeParticlesToStream(), mrpt::config::CConfigFile::writeString(), mrpt::config::CConfigFileMemory::writeString(), and mrpt::gui::WxSubsystem::wxMainThread().

◆ MRPT_THROW_UNKNOWN_SERIALIZATION_VERSION

#define MRPT_THROW_UNKNOWN_SERIALIZATION_VERSION (   __V)
Value:
"Cannot parse object: unknown serialization version number: '%i'", \
static_cast<int>(__V)))
#define THROW_EXCEPTION(msg)
Definition: exceptions.h:67
std::string std::string format(std::string_view fmt, ARGS &&... args)
Definition: format.h:26

For use in CSerializable implementations.

Definition at line 97 of file exceptions.h.

Referenced by mrpt::nav::CPTG_DiffDrive_CollisionGridBased::internal_readFromStream(), mrpt::nav::CParameterizedTrajectoryGenerator::internal_readFromStream(), mrpt::nav::CPTG_RobotShape_Polygonal::internal_shape_loadFromStream(), mrpt::nav::CPTG_RobotShape_Circular::internal_shape_loadFromStream(), mrpt::kinematics::operator>>(), mrpt::opengl::CRenderizableShaderPoints::params_deserialize(), mrpt::graphs::detail::graph_ops< graph_t >::read_graph_of_poses_from_binary_file(), mrpt::obs::TPixelLabelInfoBase::readAndBuildFromStream(), mrpt::opengl::TLightParameters::readFromStream(), mrpt::nav::ClearanceDiagram::readFromStream(), mrpt::nav::CParameterizedTrajectoryGenerator::TNavDynamicState::readFromStream(), mrpt::maps::COctoMapBase< octree_t, octree_node_t >::TLikelihoodOptions::readFromStream(), mrpt::maps::CPointsMap::TInsertionOptions::readFromStream(), mrpt::maps::COctoMapBase< octree_t, octree_node_t >::TRenderingOptions::readFromStream(), mrpt::maps::CPointsMap::TLikelihoodOptions::readFromStream(), mrpt::maps::CPointsMap::TRenderOptions::readFromStream(), mrpt::maps::COccupancyGridMap3D::TRenderingOptions::readFromStream(), mrpt::opengl::CRenderizableShaderTexturedTriangles::readFromStreamTexturedObject(), mrpt::opengl::CSimpleLine::serializeFrom(), mrpt::kinematics::CVehicleVelCmd_DiffDriven::serializeFrom(), mrpt::kinematics::CVehicleVelCmd_Holo::serializeFrom(), mrpt::opengl::CTexturedPlane::serializeFrom(), mrpt::poses::CPoint2DPDFGaussian::serializeFrom(), mrpt::math::CPolygon::serializeFrom(), mrpt::obs::CObservationRobotPose::serializeFrom(), mrpt::opengl::CSetOfTexturedTriangles::serializeFrom(), mrpt::math::CMatrixB::serializeFrom(), mrpt::obs::CObservationCANBusJ1939::serializeFrom(), mrpt::hmtslam::CPropertiesValuesList::serializeFrom(), mrpt::opengl::CSetOfTriangles::serializeFrom(), mrpt::math::CMatrixF::serializeFrom(), mrpt::poses::CPointPDFGaussian::serializeFrom(), mrpt::img::TStereoCamera::serializeFrom(), mrpt::poses::CPoses3DSequence::serializeFrom(), mrpt::obs::CObservationRFID::serializeFrom(), mrpt::obs::CObservationReflectivity::serializeFrom(), mrpt::math::CSplineInterpolator1D::serializeFrom(), mrpt::math::CMatrixD::serializeFrom(), mrpt::obs::CObservationComment::serializeFrom(), mrpt::poses::CPosePDFGrid::serializeFrom(), mrpt::poses::CPoses2DSequence::serializeFrom(), mrpt::obs::CObservationBeaconRanges::serializeFrom(), mrpt::obs::CObservationGasSensors::serializeFrom(), mrpt::nav::CPTG_DiffDrive_CCS::serializeFrom(), mrpt::nav::CPTG_DiffDrive_CS::serializeFrom(), mrpt::nav::CPTG_DiffDrive_CC::serializeFrom(), mrpt::obs::CObservationSkeleton::serializeFrom(), mrpt::obs::CObservationVisualLandmarks::serializeFrom(), mrpt::nav::CLogFileRecord_VFF::serializeFrom(), mrpt::obs::CObservation6DFeatures::serializeFrom(), mrpt::poses::CPose3DPDFGrid::serializeFrom(), mrpt::nav::CPTG_Holo_Blend::serializeFrom(), mrpt::obs::CActionCollection::serializeFrom(), mrpt::img::TCamera::serializeFrom(), mrpt::opengl::CSetOfObjects::serializeFrom(), mrpt::obs::CObservationWirelessPower::serializeFrom(), mrpt::obs::CActionRobotMovement3D::serializeFrom(), mrpt::maps::CPointsMapXYZI::serializeFrom(), mrpt::obs::CObservationRange::serializeFrom(), mrpt::opengl::CArrow::serializeFrom(), mrpt::obs::CObservationWindSensor::serializeFrom(), mrpt::obs::CObservationBearingRange::serializeFrom(), mrpt::poses::CPosePDFGaussian::serializeFrom(), mrpt::obs::CObservationRawDAQ::serializeFrom(), mrpt::obs::CObservationOdometry::serializeFrom(), mrpt::opengl::CSphere::serializeFrom(), mrpt::maps::CWeightedPointsMap::serializeFrom(), mrpt::opengl::CGridPlaneXY::serializeFrom(), mrpt::opengl::CGridPlaneXZ::serializeFrom(), mrpt::nav::CLogFileRecord::serializeFrom(), mrpt::poses::CPointPDFParticles::serializeFrom(), mrpt::maps::CColouredPointsMap::serializeFrom(), mrpt::opengl::CAxis::serializeFrom(), mrpt::opengl::CCylinder::serializeFrom(), mrpt::opengl::CDisk::serializeFrom(), mrpt::maps::CSimplePointsMap::serializeFrom(), mrpt::obs::CActionRobotMovement2D::serializeFrom(), mrpt::hmtslam::CHierarchicalMHMap::serializeFrom(), mrpt::obs::CObservationBatteryState::serializeFrom(), mrpt::obs::CObservationImage::serializeFrom(), mrpt::maps::CSimpleMap::serializeFrom(), mrpt::maps::CWirelessPowerGridMap2D::serializeFrom(), mrpt::maps::CGasConcentrationGridMap2D::serializeFrom(), mrpt::poses::CPoint3D::serializeFrom(), mrpt::poses::CPose3DPDFSOG::serializeFrom(), mrpt::opengl::CSetOfLines::serializeFrom(), mrpt::obs::CObservationPointCloud::serializeFrom(), mrpt::poses::CPoint2D::serializeFrom(), mrpt::poses::CPointPDFSOG::serializeFrom(), mrpt::hmtslam::CHMHMapArc::serializeFrom(), mrpt::opengl::CCamera::serializeFrom(), mrpt::maps::CHeightGridMap2D_MRF::serializeFrom(), mrpt::poses::CPosePDFGaussianInf::serializeFrom(), mrpt::poses::CPosePDFSOG::serializeFrom(), mrpt::nav::CPTG_DiffDrive_alpha::serializeFrom(), mrpt::maps::CBeacon::serializeFrom(), mrpt::opengl::CText::serializeFrom(), mrpt::maps::COccupancyGridMap3D::serializeFrom(), mrpt::maps::CLandmark::serializeFrom(), mrpt::opengl::CColorBar::serializeFrom(), mrpt::hmtslam::CMHPropertiesValuesList::serializeFrom(), mrpt::obs::CObservationStereoImagesFeatures::serializeFrom(), mrpt::opengl::CVectorField2D::serializeFrom(), mrpt::hmtslam::CHMHMapNode::serializeFrom(), mrpt::poses::CPose3DPDFParticles::serializeFrom(), mrpt::hmtslam::CRobotPosesGraph::serializeFrom(), mrpt::obs::CObservationStereoImages::serializeFrom(), mrpt::opengl::CMesh::serializeFrom(), mrpt::opengl::CMeshFast::serializeFrom(), mrpt::maps::CColouredOctoMap::serializeFrom(), mrpt::poses::CPosePDFParticles::serializeFrom(), mrpt::opengl::CVectorField3D::serializeFrom(), mrpt::poses::CPose3DPDFGaussian::serializeFrom(), mrpt::nav::CPTG_DiffDrive_C::serializeFrom(), mrpt::poses::CPose3DPDFGaussianInf::serializeFrom(), mrpt::maps::CReflectivityGridMap2D::serializeFrom(), mrpt::opengl::CBox::serializeFrom(), mrpt::poses::CPose2D::serializeFrom(), mrpt::maps::COctoMap::serializeFrom(), mrpt::opengl::CText3D::serializeFrom(), mrpt::maps::CBeaconMap::serializeFrom(), mrpt::poses::CPose3DQuatPDFGaussianInf::serializeFrom(), mrpt::poses::CPose3DQuatPDFGaussian::serializeFrom(), mrpt::opengl::CAssimpModel::serializeFrom(), mrpt::opengl::CAngularObservationMesh::serializeFrom(), mrpt::hmtslam::CLSLAMParticleData::serializeFrom(), mrpt::opengl::CPolyhedron::serializeFrom(), mrpt::poses::CPose3DQuat::serializeFrom(), mrpt::opengl::CPointCloudColoured::serializeFrom(), mrpt::nav::CHolonomicVFF::serializeFrom(), mrpt::opengl::CPointCloud::serializeFrom(), mrpt::poses::CPose3DInterpolator::serializeFrom(), mrpt::poses::CPose2DInterpolator::serializeFrom(), mrpt::obs::CSensoryFrame::serializeFrom(), mrpt::nav::CHolonomicND::serializeFrom(), mrpt::opengl::CFrustum::serializeFrom(), mrpt::obs::CObservation2DRangeScan::serializeFrom(), mrpt::maps::COccupancyGridMap2D::serializeFrom(), mrpt::vision::CFeature::serializeFrom(), mrpt::slam::CIncrementalMapPartitioner::serializeFrom(), mrpt::nav::CHolonomicFullEval::serializeFrom(), mrpt::opengl::COpenGLScene::serializeFrom(), mrpt::opengl::CPlanarLaserScan::serializeFrom(), mrpt::obs::CObservationRotatingScan::serializeFrom(), mrpt::opengl::COpenGLViewport::serializeFrom(), mrpt::obs::CRawlog::serializeFrom(), mrpt::maps::CHeightGridMap2D::serializeFrom(), mrpt::maps::CMultiMetricMapPDF::serializeFrom(), mrpt::obs::CObservationGPS::serializeFrom(), mrpt::kinematics::CKinematicChain::serializeFrom(), mrpt::opengl::COctoMapVoxels::serializeFrom(), mrpt::hmtslam::CLocalMetricHypothesis::serializeFrom(), mrpt::hmtslam::CHMTSLAM::serializeFrom(), mrpt::maps::CLandmarksMap::serializeFrom(), mrpt::hmtslam::THypothesisIDSet::serializeFrom(), mrpt::maps::CRandomFieldGridMap3D::serializeFrom(), mrpt::maps::TMapGenericParams::serializeFrom(), mrpt::obs::CObservationVelodyneScan::serializeFrom(), mrpt::obs::CObservationRGBD360::serializeFrom(), mrpt::poses::CPose3D::serializeFrom(), mrpt::obs::CObservationIMU::serializeFrom(), mrpt::maps::CMultiMetricMap::serializeFrom(), mrpt::img::CImage::serializeFrom(), mrpt::nav::CLogFileRecord_FullEval::serializeFrom(), mrpt::nav::CLogFileRecord_ND::serializeFrom(), mrpt::obs::CObservation3DRangeScan::serializeFrom(), and mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::thisclass_readFromStream().

◆ MRPT_TRY_END

#define MRPT_TRY_END

◆ MRPT_TRY_END_WITH_CLEAN_UP

#define MRPT_TRY_END_WITH_CLEAN_UP (   stuff)
Value:
} \
catch (std::bad_alloc&) { throw; } \
catch (...) { {stuff} THROW_STACKED_EXCEPTION; }
#define THROW_STACKED_EXCEPTION
Definition: exceptions.h:79

The end of a standard MRPT "try...catch()" block that allows tracing throw the call stack after an exception, including a "clean up" piece of code to be run before throwing the exceptions.

See also
MRPT_TRY_END,MRPT_TRY_START

Definition at line 224 of file exceptions.h.

◆ MRPT_TRY_START

#define MRPT_TRY_START

◆ THROW_EXCEPTION

#define THROW_EXCEPTION (   msg)    THROW_TYPED_EXCEPTION(msg, std::logic_error)
Parameters
msgThis can be a char*, a std::string, or a literal string. Defines a unified way of reporting exceptions
See also
MRPT_TRY_START, MRPT_TRY_END, THROW_EXCEPTION_FMT
Examples:
core_exceptions_example/test.cpp.

Definition at line 67 of file exceptions.h.

Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::poses::CPoses3DSequence::absolutePoseOf(), mrpt::poses::CPoses2DSequence::absolutePoseOf(), mrpt::graphslam::detail::CEdgeCounter::addEdge(), mrpt::graphslam::detail::CEdgeCounter::addEdgeType(), mrpt::slam::CIncrementalMapPartitioner::addMapFrame(), mrpt::img::TColorManager::advanceRGBCounters(), mrpt::slam::CGridMapAligner::Align3DPDF(), mrpt::slam::CICP::Align3DPDF(), mrpt::slam::CGridMapAligner::AlignPDF(), mrpt::slam::CGridMapAligner::AlignPDF_robustMatch(), mrpt::poses::CPose3DPDFParticles::append(), mrpt::hwdrivers::CGenericSensor::appendObservations(), mrpt::serialization::archiveJSON(), mrpt::img::CImage::asCvMatRef(), mrpt::math::averageLogLikelihood(), mrpt::poses::CPose3DPDFGrid::bayesianFusion(), mrpt::poses::CPosePDFGrid::bayesianFusion(), mrpt::poses::CPointPDFParticles::bayesianFusion(), mrpt::poses::CPose3DPDFParticles::bayesianFusion(), mrpt::poses::CPose3DPDFSOG::bayesianFusion(), mrpt::maps::CBeacon::bayesianFusion(), mrpt::poses::CPose3DPDFGaussianInf::bayesianFusion(), mrpt::poses::CPosePDFParticles::bayesianFusion(), mrpt::poses::CPose3DPDFGaussian::bayesianFusion(), mrpt::gui::C3DWindowDialog::C3DWindowDialog(), mrpt::detectors::CCascadeClassifierDetection::CCascadeClassifierDetection(), mrpt::comms::CClientTCPSocket::CClientTCPSocket(), mrpt::hwdrivers::CDUO3DCamera::CDUO3DCamera(), mrpt::img::CEnhancedMetaFile::CEnhancedMetaFile(), mrpt::opengl::CFBORender::CFBORender(), mrpt::io::CFileGZOutputStream::CFileGZOutputStream(), mrpt::system::CFileSystemWatcher::CFileSystemWatcher(), mrpt::hwdrivers::CImageGrabber_dc1394::changeCaptureOptions(), mrpt::poses::CPosePDFGrid::changeCoordinatesReference(), mrpt::poses::CPose3DPDFGrid::changeCoordinatesReference(), mrpt::maps::CBeacon::changeCoordinatesReference(), mrpt::system::changeCurrentProcessPriority(), mrpt::hwdrivers::CGyroKVHDSP3000::changeMode(), mrpt::poses::CPoses3DSequence::changePose(), mrpt::poses::CPoses2DSequence::changePose(), mrpt::nav::CReactiveNavigationSystem::changeRobotShape(), mrpt::nav::CReactiveNavigationSystem3D::changeRobotShape(), mrpt::poses::CPose3DQuat::iterator::check_limits(), mrpt::poses::CPose3DQuat::const_iterator::check_limits(), mrpt::hwdrivers::CRoboPeakLidar::checkCOMMs(), mrpt::comms::CInterfaceFTDI::checkErrorAndRaise(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::checkRegistrationCondition3D(), mrpt::hmtslam::CHMTSLAM::CHMTSLAM(), mrpt::hwdrivers::CImageGrabber_dc1394::CImageGrabber_dc1394(), mrpt::hwdrivers::CImageGrabber_OpenCV::CImageGrabber_OpenCV(), mrpt::hwdrivers::CIMUIntersense::CIMUIntersense(), mrpt::hwdrivers::CIMUXSens_MT4::CIMUXSens_MT4(), mrpt::hwdrivers::CKinect::CKinect(), mrpt::hwdrivers::COpenNI2Generic::close(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::close(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::CMatrixDynamic(), mrpt::graphs::detail::CMRVisualizer< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::CMRVisualizer(), mrpt::hwdrivers::CMyntEyeCamera::CMyntEyeCamera(), mrpt::img::colormap(), mrpt::opengl::Shader::compile(), mrpt::io::zip::compress_gz_data_block(), mrpt::math::CSparseMatrix::compressFromTriplet(), mrpt::maps::CMetricMap::compute3DMatchingRatio(), mrpt::maps::COccupancyGridMap3D::compute3DMatchingRatio(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::maps::CLandmarksMap::computeLikelihood_SIFT_LandmarkMap(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::hmtslam::CHierarchicalMapMHPartition::computeMatchProbabilityBetweenNodes(), mrpt::bayes::CParticleFilterCapable::computeResampling(), mrpt::vision::computeSAD(), mrpt::vision::computeStereoRectificationMaps(), mrpt::poses::CPoses3DSequence::computeTraveledDistanceAfter(), mrpt::poses::CPoses2DSequence::computeTraveledDistanceAfter(), mrpt::comms::CClientTCPSocket::connect(), ConnectWlanServerW(), mrpt::hwdrivers::COpenNI2Generic::COpenNI2Generic(), mrpt::poses::CPosePDFGrid::copyFrom(), mrpt::poses::CPose3DPDFGrid::copyFrom(), mrpt::poses::CPose3DPDFParticles::copyFrom(), mrpt::poses::CPointPDFParticles::copyFrom(), mrpt::maps::CBeacon::copyFrom(), mrpt::img::CImage::correlate(), mrpt::maps::CHeightGridMap2D::countObservedCells(), mrpt::hwdrivers::CPhidgetInterfaceKitProximitySensors::CPhidgetInterfaceKitProximitySensors(), mrpt::io::CPipeBaseEndPoint::CPipeBaseEndPoint(), mrpt::poses::CPose3DPDF::createFrom2D(), mrpt::gui::CBaseGUIWindow::createWxWindow(), mrpt::math::cross_correlation_FFT(), mrpt::comms::CServerTCPSocket::CServerTCPSocket(), mrpt::hwdrivers::CSkeletonTracker::CSkeletonTracker(), mrpt::hwdrivers::CSwissRanger3DCamera::CSwissRanger3DCamera(), mrpt::hmtslam::CTopLCDetector_FabMap::CTopLCDetector_FabMap(), mrpt::hwdrivers::CVelodyneScanner::CVelodyneScanner(), mrpt::slam::data_association_full_covariance(), mrpt::opengl::Program::declareAttribute(), mrpt::opengl::Program::declareUniform(), mrpt::hwdrivers::CSICKTim561Eth::decodeScan(), mrpt::hwdrivers::CLMS100Eth::decodeScan(), mrpt::vision::CFeature::descriptorDistanceTo(), mrpt::vision::CFeatureExtraction::detectFeatures(), mrpt::maps::CMetricMap::determineMatching2D(), mrpt::maps::COccupancyGridMap3D::determineMatching2D(), mrpt::maps::CMetricMap::determineMatching3D(), mrpt::containers::bimap< mrpt::maps::CLandmark::TLandmarkID, unsigned int >::direct(), mrpt::math::TPolygon2D::distance(), do_rectify(), mrpt::poses::CPoseRandomSampler::do_sample_2D(), mrpt::poses::CPoseRandomSampler::do_sample_3D(), mrpt::hwdrivers::CGillAnemometer::doProcess(), mrpt::hwdrivers::CRaePID::doProcess(), mrpt::hwdrivers::CIMUXSens_MT4::doProcess(), mrpt::hwdrivers::CSICKTim561Eth::doProcess(), mrpt::hwdrivers::CIMUIntersense::doProcess(), mrpt::hwdrivers::CLMS100Eth::doProcess(), mrpt::hwdrivers::CSkeletonTracker::doProcess(), mrpt::hwdrivers::CPhidgetInterfaceKitProximitySensors::doProcess(), mrpt::hwdrivers::CSwissRanger3DCamera::doProcess(), mrpt::hwdrivers::CGPSInterface::doProcess(), mrpt::hwdrivers::CNationalInstrumentsDAQ::doProcess(), mrpt::hwdrivers::COpenNI2_RGBD360::doProcess(), mrpt::hwdrivers::COpenNI2Sensor::doProcess(), mrpt::hwdrivers::CKinect::doProcess(), mrpt::gui::CDisplayWindowGUI::drawContents(), mrpt::gui::MRPT2NanoguiGLCanvas::drawGL(), mrpt::img::CEnhancedMetaFile::drawImage(), mrpt::poses::CPosePDFGrid::drawManySamples(), mrpt::poses::CPose3DPDFGrid::drawManySamples(), mrpt::poses::CPose3DPDFParticles::drawManySamples(), mrpt::poses::CPose3DPDFSOG::drawManySamples(), mrpt::poses::CPosePDFSOG::drawManySamples(), mrpt::img::CCanvas::drawMark(), mrpt::poses::CPoseRandomSampler::drawSample(), mrpt::poses::CPointPDFParticles::drawSingleSample(), mrpt::poses::CPose3DPDFGrid::drawSingleSample(), mrpt::poses::CPosePDFGrid::drawSingleSample(), mrpt::poses::CPose3DPDFParticles::drawSingleSample(), mrpt::maps::CBeacon::drawSingleSample(), mrpt::poses::CPose3DPDFSOG::drawSingleSample(), mrpt::poses::CPosePDFSOG::drawSingleSample(), mrpt::hmtslam::CHierarchicalMHMap::dumpAsXMLfile(), mrpt::hwdrivers::CHokuyoURG::ensureStreamIsOpen(), mrpt::hwdrivers::CImageGrabber_dc1394::enumerateCameras(), mrpt::img::CImage::equalizeHist(), mrpt::obs::CActionCollection::eraseByIndex(), mrpt::poses::CPose3DPDFGaussianInf::evaluateNormalizedPDF(), mrpt::poses::CPose3DPDFGaussian::evaluateNormalizedPDF(), mrpt::poses::CPose3DPDFGaussianInf::evaluatePDF(), mrpt::poses::CPose3DPDFGaussian::evaluatePDF(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::exactBisection(), mrpt::obs::stock_observations::exampleImage(), mrpt::system::CDirectoryExplorer::explore(), mrpt::vision::CFeatureExtraction::extractFeaturesAKAZE(), mrpt::vision::CFeatureExtraction::extractFeaturesKLT(), mrpt::vision::CFeatureExtraction::extractFeaturesLSD(), mrpt::vision::CFeatureExtraction::extractFeaturesSIFT(), mrpt::vision::CFeatureExtraction::extractFeaturesSURF(), mrpt::vision::CFeatureLines::extractLines(), mrpt::bayes::CParticleFilterCapable::fastDrawSample(), mrpt::system::os::fclose(), fill_input_buffer(), mrpt::vision::find_descriptor_pairings(), mrpt::obs::CRawlog::findObservationsByClassInRange(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::findPathByEnds(), mrpt::obs::CObservationRotatingScan::fromPointCloud(), mrpt::poses::CPoint< CPoint3D, 3 >::fromString(), mrpt::math::TTwist2D::fromString(), mrpt::math::TPose3DQuat::fromString(), mrpt::math::TPose2D::fromString(), mrpt::math::TTwist3D::fromString(), mrpt::math::TPoint2D_< double >::fromString(), mrpt::math::TPose3D::fromString(), mrpt::math::TPoint3D_< float >::fromString(), mrpt::poses::CPose3DQuat::fromString(), mrpt::poses::CPose2D::fromString(), mrpt::poses::CPose3D::fromString(), mrpt::obs::CObservationRotatingScan::fromVelodyne(), mrpt::math::generateAxisBaseFromDirection(), mrpt::maps::CSimpleMap::get(), mrpt::obs::CActionCollection::get(), mrpt::obs::CObservation3DRangeScan::get_unproj_lut(), mrpt::hmtslam::CMHPropertiesValuesList::getAs(), mrpt::maps::CBeacon::getAs3DObject(), mrpt::obs::CRawlog::getAsAction(), mrpt::obs::CRawlog::getAsGeneric(), mrpt::maps::CBeacon::getAsMatlabDrawCommands(), mrpt::maps::CRandomFieldGridMap2D::getAsMatrix(), mrpt::obs::CRawlog::getAsObservation(), mrpt::obs::CRawlog::getAsObservations(), mrpt::maps::COctoMap::getAsOctoMapVoxels(), mrpt::maps::COccupancyGridMap3D::getAsOctoMapVoxels(), mrpt::math::CHistogram::getBinCount(), mrpt::math::CHistogram::getBinRatio(), mrpt::img::CImage::getChannelCount(), mrpt::img::CImage::getChannelsOrder(), mrpt::hwdrivers::COpenNI2Generic::getColorSensorParam(), mrpt::hwdrivers::COpenNI2Generic::getConnectedDevices(), mrpt::config::CConfigFileBase::getContentAsYAML(), mrpt::maps::CBeacon::getCovarianceAndMean(), mrpt::hmtslam::CLocalMetricHypothesis::getCurrentPose(), mrpt::system::getcwd(), mrpt::hwdrivers::COpenNI2Generic::getDepthSensorParam(), mrpt::hwdrivers::CRoboPeakLidar::getDeviceHealth(), mrpt::hwdrivers::COpenNI2Generic::getDeviceIDFromSerialNum(), mrpt::hmtslam::CMHPropertiesValuesList::getElemental(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::getFC2version(), mrpt::hwdrivers::CRoboticHeadInterface::GetGain(), mrpt::apps::MonteCarloLocalization_Base::getGroundTruth(), mrpt::slam::CMonteCarloLocalization3D::getLastPose(), mrpt::slam::CMonteCarloLocalization2D::getLastPose(), mrpt::maps::CMultiMetricMapPDF::getLastPose(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap(), mrpt::poses::CPointPDFParticles::getMean(), mrpt::maps::CBeacon::getMean(), mrpt::opengl::CRenderizableShaderTexturedTriangles::getNewTextureNumber(), mrpt::hwdrivers::CCameraSensor::getNextFrame(), mrpt::hwdrivers::COpenNI2Generic::getNextFrameD(), mrpt::hwdrivers::COpenNI2Generic::getNextFrameRGB(), mrpt::hwdrivers::COpenNI2Generic::getNextFrameRGBD(), mrpt::hwdrivers::COpenNI2_RGBD360::getNextObservation(), mrpt::hwdrivers::COpenNI2Sensor::getNextObservation(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::getNodeDistanceToRoot(), mrpt::graphslam::detail::CEdgeCounter::getNumForEdgeType(), mrpt::hwdrivers::CMyntEyeCamera::getObservation(), mrpt::hwdrivers::CImageGrabber_OpenCV::getObservation(), mrpt::hwdrivers::CPhidgetInterfaceKitProximitySensors::getObservation(), mrpt::hwdrivers::CImageGrabber_dc1394::getObservation(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::getObservation(), mrpt::maps::CMultiMetricMapPDF::getPath(), mrpt::img::CMappedImage::getPixel(), mrpt::img::CImage::getPixelDepth(), mrpt::maps::CColouredPointsMap::getPointColor(), mrpt::maps::CPointsMapXYZI::getPointIntensity(), mrpt::maps::CColouredPointsMap::getPointRGB(), mrpt::maps::CPointsMapXYZI::getPointRGB(), mrpt::poses::CPoses3DSequence::getPose(), mrpt::poses::CPoses2DSequence::getPose(), mrpt::poses::internal::getPoseFromString< false, true >(), mrpt::io::CFileGZOutputStream::getPosition(), mrpt::io::CFileGZInputStream::getPosition(), mrpt::comms::CClientTCPSocket::getPosition(), mrpt::comms::CSerialPort::getPosition(), mrpt::hwdrivers::CWirelessPower::GetPower(), mrpt::comms::CClientTCPSocket::getReadPendingBytes(), mrpt::vision::CStereoRectifyMap::getRectifiedImageParams(), mrpt::vision::CStereoRectifyMap::getRectifiedLeftImageParams(), mrpt::vision::CStereoRectifyMap::getRectifiedRightImageParams(), mrpt::img::CImage::getRowStride(), mrpt::img::CImage::getSize(), mrpt::io::CFileGZInputStream::getTotalBytesCount(), mrpt::io::CFileGZOutputStream::getTotalBytesCount(), mrpt::comms::CClientTCPSocket::getTotalBytesCount(), mrpt::comms::CSerialPort::getTotalBytesCount(), mrpt::obs::CRawlog::getType(), mrpt::opengl::internal::glDrawText(), mrpt::img::CImage::grayscale(), GUID2Str(), mrpt::math::idft2_real(), mrpt::poses::CPoseInterpolatorBase< 3 >::impl_interpolation(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initClass(), mrpt::apps::CGridMapAlignerApp::initialize(), mrpt::apps::KFSLAMApp::initialize(), mrpt::hwdrivers::CIMUXSens_MT4::initialize(), mrpt::hwdrivers::CSICKTim561Eth::initialize(), mrpt::hwdrivers::CGyroKVHDSP3000::initialize(), mrpt::hwdrivers::CIMUIntersense::initialize(), mrpt::hwdrivers::CLMS100Eth::initialize(), mrpt::hwdrivers::CSwissRanger3DCamera::initialize(), mrpt::hwdrivers::CSkeletonTracker::initialize(), mrpt::hwdrivers::CPhidgetInterfaceKitProximitySensors::initialize(), mrpt::hwdrivers::CNationalInstrumentsDAQ::initialize(), mrpt::hwdrivers::COpenNI2_RGBD360::initialize(), mrpt::hwdrivers::COpenNI2Sensor::initialize(), mrpt::hwdrivers::CVelodyneScanner::initialize(), mrpt::hwdrivers::CCameraSensor::initialize(), mrpt::io::CPipe::initializePipe(), mrpt::opengl::CRenderizableShaderTexturedTriangles::initializeTextures(), mrpt::math::CSparseMatrix::insert_entry(), mrpt::math::CSparseMatrix::insert_submatrix(), mrpt::maps::CRandomFieldGridMap2D::insertIndividualReading(), mrpt::maps::CMetricMap::insertObservationPtr(), mrpt::maps::CGasConcentrationGridMap2D::internal_clear(), mrpt::maps::CRandomFieldGridMap2D::internal_clear(), mrpt::vision::CFeatureExtraction::internal_computeBLDLineDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeLATCHDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeLogPolarImageDescriptors(), mrpt::maps::CBeaconMap::internal_computeObservationLikelihood(), mrpt::maps::CWirelessPowerGridMap2D::internal_computeObservationLikelihood(), mrpt::maps::CHeightGridMap2D_MRF::internal_computeObservationLikelihood(), mrpt::maps::CGasConcentrationGridMap2D::internal_computeObservationLikelihood(), mrpt::maps::CHeightGridMap2D::internal_computeObservationLikelihood(), mrpt::maps::COccupancyGridMap3D::internal_computeObservationLikelihood(), mrpt::vision::CFeatureExtraction::internal_computePolarImageDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeSiftDescriptors(), mrpt::vision::CFeatureExtraction::internal_computeSurfDescriptors(), mrpt::img::CImage::internal_fromIPL(), mrpt::maps::CBeaconMap::internal_insertObservation(), mrpt::maps::detail::pointmap_traits< CColouredPointsMap >::internal_loadFromRangeScan2D_prepareOneRange(), mrpt::maps::detail::pointmap_traits< CColouredPointsMap >::internal_loadFromRangeScan3D_prepareOneRange(), mrpt::hwdrivers::CVelodyneScanner::internal_read_PCAP_packet(), mrpt::serialization::CArchive::internal_ReadObject(), mrpt::serialization::CArchive::internal_ReadObjectHeader(), mrpt::hwdrivers::CVelodyneScanner::internal_receive_UDP_packet(), mrpt::nav::CParameterizedTrajectoryGenerator::internal_TPObsDistancePostprocess(), mrpt::math::intersect(), mrpt::poses::CPose3DPDFGrid::inverse(), mrpt::poses::CPosePDFGrid::inverse(), mrpt::containers::bimap< mrpt::maps::CLandmark::TLandmarkID, unsigned int >::inverse(), mrpt::img::CImage::isColor(), mrpt::img::CImage::isEmpty(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeClosestPoint2D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeClosestPoint3D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint2D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint2DIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3D(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3DIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeNClosestPoint3DWithIdx(), mrpt::math::KDTreeCapable< CFeatureList >::kdTreeTwoClosestPoint2D(), mrpt::hwdrivers::COpenNI2Generic::kill(), mrpt::opengl::Program::linkProgram(), mrpt::hwdrivers::CWirelessPower::ListInterfaces(), ListInterfacesW(), mrpt::hwdrivers::CWirelessPower::ListNetworks(), mrpt::hwdrivers::CSickLaserSerial::LMS_setupBaudrate(), mrpt::graphs::detail::graph_ops< graph_t >::load_graph_of_poses_from_text_stream(), mrpt::hwdrivers::CWirelessPower::loadConfig_sensorSpecific(), mrpt::hwdrivers::CPhidgetInterfaceKitProximitySensors::loadConfig_sensorSpecific(), mrpt::hwdrivers::CVelodyneScanner::loadConfig_sensorSpecific(), mrpt::nav::CNavigatorManualSequence::loadConfigFile(), mrpt::opengl::LoadDefaultShader(), mrpt::comms::CInterfaceFTDI::loadDriver(), mrpt::img::TCamera::loadFromConfigFile(), mrpt::img::CImage::loadFromFile(), mrpt::img::CImage::loadFromMemoryBuffer(), mrpt::vision::TSequenceFeatureObservations::loadFromTextFile(), mrpt::vision::CFeatureList::loadFromTextFile(), mrpt::obs::VelodyneCalibration::loadFromXMLFile(), mrpt::hmtslam::CHierarchicalMHMap::loadFromXMLfile(), mrpt::obs::VelodyneCalibration::loadFromXMLText(), mrpt::img::CImage::loadFromXPM(), mrpt::obs::VelodyneCalibration::loadFromYAMLFile(), mrpt::obs::VelodyneCalibration::loadFromYAMLText(), mrpt::ros1bridge::MapHdl::loadMap(), mrpt::opengl::CMesh3D::loadMesh(), mrpt::opengl::CAssimpModel::loadScene(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_AA(), mrpt::hwdrivers::TCaptureOptions_DUO3D::m_camera_ext_params_from_yml(), mrpt::hwdrivers::TCaptureOptions_DUO3D::m_camera_int_params_from_yml(), mrpt::hwdrivers::TCaptureOptions_DUO3D::m_rectify_map_from_yml(), mrpt::img::CImage::makeDeepCopy(), mrpt::img::CImage::makeSureImageIsLoaded(), mrpt::vision::matchFeatures(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::gui::MRPTImage2wxBitmap(), mrpt::gui::MRPTImage2wxImage(), mrpt::non_copiable_ptr_basic< void >::non_copiable_ptr_basic(), mrpt::math::noncentralChi2PDF_CDF(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionJacobian(), mrpt::slam::CRangeBearingKFSLAM2D::OnTransitionNoise(), mrpt::slam::CRangeBearingKFSLAM::OnTransitionNoise(), mrpt::comms::CSerialPort::open(), mrpt::hwdrivers::COpenNI2Generic::open(), mrpt::hwdrivers::CDUO3DCamera::open(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::open(), mrpt::hwdrivers::CKinect::open(), mrpt::vision::openCV_cross_correlation(), mrpt::hwdrivers::COpenNI2Generic::openDevicesBySerialNum(), mrpt::math::CVectorDynamic< KFTYPE >::operator()(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator()(), mrpt::img::CImage::operator()(), mrpt::poses::CPose3DPDFParticles::operator+=(), mrpt::vision::CVideoFileWriter::operator<<(), mrpt::non_copiable_ptr_basic< void >::operator=(), mrpt::non_copiable_ptr< T >::operator=(), mrpt::math::TObject3D::operator=(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator=(), mrpt::hmtslam::CHMTSLAM::operator=(), mrpt::serialization::operator>>(), mrpt::topography::path_from_rtk_gps(), mrpt::nav::CAbstractPTGBasedReactive::performNavigationStep(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_gatherActionsCheckBothActObs(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfStandardProposal(), mrpt::bayes::CParticleFilterCapable::prediction_and_update(), mrpt::bayes::CParticleFilterCapable::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::prediction_and_update_pfAuxiliaryPFOptimal(), mrpt::bayes::CParticleFilterCapable::prediction_and_update_pfAuxiliaryPFStandard(), mrpt::maps::CMultiMetricMapPDF::prediction_and_update_pfOptimalProposal(), mrpt::bayes::CParticleFilterCapable::prediction_and_update_pfOptimalProposal(), mrpt::hmtslam::CLSLAM_RBPF_2DLASER::prediction_and_update_pfOptimalProposal(), mrpt::bayes::CParticleFilterCapable::prediction_and_update_pfStandardProposal(), mrpt::maps::CRandomFieldGridMap2D::predictMeasurement(), mrpt::bayes::CParticleFilterCapable::prepareFastDrawSample(), mrpt::hwdrivers::prepareVideoSourceFromPanel(), mrpt::hwdrivers::prepareVideoSourceFromUserSelection(), mrpt::apps::RawlogGrabberApp::process_observations_for_sf(), mrpt::vision::pinhole::projectPoints_with_distortion(), mrpt::comms::CSerialPort::purgeBuffers(), mrpt::hwdrivers::CHokuyoURG::purgeBuffers(), mrpt::obs::CObservation3DRangeScan::rangeImageAsImage(), mrpt::io::CFileGZOutputStream::Read(), mrpt::io::CFileOutputStream::Read(), mrpt::io::CFileGZInputStream::Read(), mrpt::comms::CSerialPort::Read(), mrpt::config::CConfigFileBase::read_string_first_word(), mrpt::serialization::CArchive::ReadBuffer(), mrpt::hwdrivers::readConfigIntoVideoSourcePanel(), mrpt::opengl::CRenderizable::readFromStreamRender(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFile(), mrpt::serialization::CArchive::ReadObject(), mrpt::config::CConfigFile::readString(), mrpt::config::CConfigFileMemory::readString(), mrpt::comms::CSerialPort::ReadString(), mrpt::hwdrivers::CVelodyneScanner::receivePackets(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::maps::CSimpleMap::remove(), mrpt::obs::CRawlog::remove(), mrpt::opengl::COpenGLScene::render(), mrpt::opengl::COpenGLViewport::render(), mrpt::gui::CGlCanvasBase::renderCanvas(), mrpt::opengl::CRenderizable::requiredShaders(), mrpt::hwdrivers::CGyroKVHDSP3000::resetIncrementalAngle(), pf2gauss_t< CMonteCarloLocalization3D >::resetOnFreeSpace(), mrpt::io::CMemoryStream::resize(), mrpt::math::CMatrixFixed< double, ObsDim, PointDof >::resize(), mrpt::img::CImage::resize(), mrpt::hwdrivers::CFFMPEG_InputStream::retrieveFrame(), mrpt::slam::CRejectionSamplingRangeOnlyLocalization::RS_drawFromProposal(), mrpt::apps::CGridMapAlignerApp::run(), run_test_pf_localization(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::maps::CRandomFieldGridMap2D::saveAsMatlab3DGraph(), mrpt::slam::CMetricMapBuilderICP::saveCurrentEstimationToImage(), mrpt::maps::CRandomFieldGridMap2D::saveMetricMapRepresentationToFile(), mrpt::img::CImage::saveToFile(), mrpt::img::CImage::saveToStreamAsJPEG(), mrpt::poses::CPose3DPDFGrid::saveToTextFile(), mrpt::maps::CBeacon::saveToTextFile(), mrpt::vision::CFeature::saveToTextFile(), mrpt::vision::CFeatureList::saveToTextFile(), mrpt::img::CImage::scaleHalf(), mrpt::io::CFileInputStream::Seek(), mrpt::io::CFileOutputStream::Seek(), mrpt::io::CFileGZOutputStream::Seek(), mrpt::io::CFileGZInputStream::Seek(), mrpt::comms::CClientTCPSocket::Seek(), mrpt::comms::CSerialPort::Seek(), mrpt::opengl::CTexturedPlane::serializeFrom(), mrpt::math::CMatrixB::serializeFrom(), mrpt::opengl::CSetOfTexturedTriangles::serializeFrom(), mrpt::img::TStereoCamera::serializeFrom(), mrpt::poses::CPose3DPDFSOG::serializeFrom(), mrpt::maps::CLandmark::serializeFrom(), mrpt::maps::CRBPFParticleData::serializeFrom(), mrpt::maps::CColouredOctoMap::serializeFrom(), mrpt::maps::COctoMap::serializeFrom(), mrpt::opengl::CAssimpModel::serializeFrom(), mrpt::opengl::CPointCloudColoured::serializeFrom(), mrpt::obs::CObservationGPS::serializeFrom(), mrpt::serialization::CSerializable::serializeFrom(), mrpt::obs::CObservationRGBD360::serializeFrom(), mrpt::img::CImage::serializeFrom(), mrpt::maps::CRBPFParticleData::serializeTo(), mrpt::opengl::CAssimpModel::serializeTo(), mrpt::serialization::CSerializable::serializeTo(), mrpt::maps::CSimpleMap::set(), mrpt::comms::CSerialPort::setConfig(), mrpt::config::CConfigFileBase::setContentFromYAML(), mrpt::graphslam::detail::CEdgeCounter::setEdgesManually(), mrpt::vision::CUndistortMap::setFromCamParams(), mrpt::vision::CStereoRectifyMap::setFromCamParams(), mrpt::hwdrivers::CVelodyneScanner::setLidarReturnType(), mrpt::opengl::CSetOfLines::setLineByIndex(), mrpt::maps::CColouredPointsMap::setPointColor(), mrpt::maps::CPointsMapXYZI::setPointIntensity(), mrpt::maps::CColouredPointsMap::setPointRGB(), mrpt::maps::CPointsMapXYZI::setPointRGB(), mrpt::hwdrivers::CRoboPeakLidar::setSerialPort(), mrpt::comms::CSerialPort::setSerialPortName(), mrpt::hwdrivers::CGPSInterface::setSerialPortName(), mrpt::hwdrivers::CImageGrabber_dc1394::setSoftwareTriggerLevel(), mrpt::hwdrivers::CCameraSensor::setSoftwareTriggerLevel(), mrpt::graphslam::detail::CEdgeCounter::setTextMessageParams(), mrpt::comms::CSerialPort::setTimeouts(), mrpt::comms::CServerTCPSocket::setupSocket(), mrpt::hwdrivers::CKinect::setVideoChannel(), mrpt::gui::show_mrpt_about_box_Qt(), mrpt::gui::show_mrpt_about_box_wxWidgets(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::SpectralBisection(), mrpt::poses::CPose3DQuat::sphericalCoordinates(), mrpt::maps::CMetricMap::squareDistanceToClosestCorrespondence(), mrpt::hwdrivers::COpenNI2Generic::start(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::startCapture(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::startSyncCapture(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::stopCapture(), test_except_3rd_lvl(), mrpt::hmtslam::CHMTSLAM::thread_LSLAM(), mrpt::opengl::CBox::traceRay(), mrpt::opengl::CFrustum::traceRay(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::traceRay(), mrpt::vision::CFeatureTracker_KL::trackFeatures_impl_templ(), mrpt::opengl::CPolyhedron::truncate(), mrpt::hwdrivers::CRoboPeakLidar::turnOff(), mrpt::hwdrivers::CRoboPeakLidar::turnOn(), mrpt::vision::CUndistortMap::undistort(), mrpt::obs::CObservation3DRangeScan::undistort(), mrpt::obs::CObservationPointCloud::unload(), mrpt::graphs::ScalarFactorGraph::updateEstimation(), mrpt::maps::CRandomFieldGridMap2D::updateMapEstimation(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateMapPartitionsVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::updateState3D(), mrpt::maps::CColouredOctoMap::updateVoxelColour(), velodyne_scan_to_pointcloud(), mrpt::io::CFileInputStream::Write(), mrpt::io::CFileGZOutputStream::Write(), mrpt::io::CFileGZInputStream::Write(), mrpt::comms::CSerialPort::Write(), mrpt::serialization::CArchive::WriteBuffer(), mrpt::gui::CPanelCameraSelection::writeConfigFromVideoSourcePanel(), mrpt::hwdrivers::writeConfigFromVideoSourcePanel(), mrpt::config::CConfigFile::writeString(), and mrpt::config::CConfigFileMemory::writeString().

◆ THROW_EXCEPTION_FMT

#define THROW_EXCEPTION_FMT (   _FORMAT_STRING,
  ... 
)    THROW_EXCEPTION(mrpt::format(_FORMAT_STRING, __VA_ARGS__))

Definition at line 69 of file exceptions.h.

Referenced by mrpt::slam::CICP::Align3DPDF(), mrpt::slam::CICP::AlignPDF(), mrpt::obs::carmen_log_parse_line(), mrpt::system::CConsoleRedirector::CConsoleRedirector(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::CDijkstra(), mrpt::io::CFileInputStream::CFileInputStream(), mrpt::io::CFileOutputStream::CFileOutputStream(), mrpt::hwdrivers::CImageGrabber_OpenCV::CImageGrabber_OpenCV(), mrpt::expr::CRuntimeCompiledExpression::compile(), mrpt::vision::CFeatureExtraction::computeDescriptors(), mrpt::comms::CClientTCPSocket::connect(), mrpt::nav::CParameterizedTrajectoryGenerator::CreatePTG(), mrpt::hmtslam::CTopLCDetector_FabMap::CTopLCDetector_FabMap(), mrpt::nav::CMultiObjectiveMotionOptimizerBase::decide(), mrpt::opengl::Program::declareAttribute(), mrpt::opengl::Program::declareUniform(), mrpt::vision::defaultIntrinsicParamsMatrix(), mrpt::vision::CFeature::descriptorDistanceTo(), mrpt::apps::MonteCarloLocalization_Base::do_pf_localization(), mrpt::poses::CPoseRandomSampler::do_sample_2D(), mrpt::poses::CPoseRandomSampler::do_sample_3D(), mrpt::nav::CAbstractPTGBasedReactive::enableLogFile(), mrpt::opengl::enqueForRendering(), mrpt::obs::CSensoryFrame::eraseByIndex(), mrpt::system::CDirectoryExplorer::explore(), mrpt::maps::internal::TMetricMapTypesRegistry::factoryMapObjectFromDefinition(), mrpt::obs::CRawlog::getAsAction(), mrpt::obs::CRawlog::getAsObservation(), mrpt::obs::CRawlog::getAsObservations(), mrpt::graphs::CDirectedGraph< CPOSE, EDGE_ANNOTATIONS >::getEdge(), mrpt::hmtslam::CMHPropertiesValuesList::getElemental(), mrpt::nav::CPTG_Holo_Blend::getPathStepCount(), mrpt::kinematics::CVehicleVelCmd_DiffDriven::getVelCmdDescription(), mrpt::kinematics::CVehicleVelCmd_Holo::getVelCmdDescription(), mrpt::kinematics::CVehicleVelCmd_DiffDriven::getVelCmdElement(), mrpt::kinematics::CVehicleVelCmd_Holo::getVelCmdElement(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::getW(), mrpt::slam::CICP::ICP_Method_Classic(), mrpt::nav::CMultiObjMotionOpt_Scalarization::impl_decide(), mrpt::apps::DataSourceRawlog::impl_get_next_observations(), mrpt::apps::ICP_SLAM_App_Live::impl_initialize(), mrpt::apps::RawlogGrabberApp::initialize(), mrpt::apps::ICP_SLAM_App_Base::initialize(), mrpt::apps::MonteCarloLocalization_Base::initialize(), mrpt::apps::RBPF_SLAM_App_Base::initialize(), mrpt::hwdrivers::CIMUXSens_MT4::initialize(), mrpt::hwdrivers::CRovio::initialize(), mrpt::hwdrivers::CNTRIPEmitter::initialize(), mrpt::hwdrivers::CVelodyneScanner::initialize(), mrpt::hwdrivers::CCameraSensor::initialize(), mrpt::hmtslam::CHMTSLAM::initializeEmptyMap(), mrpt::opengl::COpenGLScene::insert(), mrpt::maps::CRandomFieldGridMap2D::insertObservation_KF2(), mrpt::nav::PlannerTPS_VirtualBase::internal_loadConfig_PTG(), mrpt::hwdrivers::CVelodyneScanner::internal_read_PCAP_packet(), mrpt::serialization::CArchive::internal_ReadObject(), mrpt::math::interpolate2points(), mrpt::obs::CObservationPointCloud::load(), mrpt::graphs::detail::graph_ops< graph_t >::load_graph_of_poses_from_text_file(), mrpt::hwdrivers::CNationalInstrumentsDAQ::loadConfig_sensorSpecific(), mrpt::hwdrivers::CCameraSensor::loadConfig_sensorSpecific(), mrpt::nav::CAbstractPTGBasedReactive::loadConfigFile(), mrpt::opengl::LoadDefaultShader(), mrpt::nav::CMultiObjectiveMotionOptimizerBase::TParamsBase::loadFromConfigFile(), mrpt::maps::CPointsMapXYZI::loadFromKittiVelodyneFile(), mrpt::vision::TSequenceFeatureObservations::loadFromTextFile(), mrpt::img::CImage::loadFromXPM(), mrpt::obs::VelodyneCalibration::loadFromYAMLFile(), mrpt::hmtslam::CHMTSLAM::loopClosureDetector_factory(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_AA(), mrpt::io::CTextFileLinesParser::open(), mrpt::comms::CSerialPort::open(), mrpt::hwdrivers::CKinect::open(), mrpt::serialization::operator>>(), mrpt::math::CVectorDynamic< KFTYPE >::operator[](), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator[](), mrpt::nav::CAbstractPTGBasedReactive::performNavigationStep(), mrpt::hmtslam::CLocalMetricHypothesis::TRobotPosesPartitioning::pose2idx(), mrpt::comms::CSerialPort::purgeBuffers(), mrpt::config::CConfigFileBase::read_enum(), mrpt::config::CConfigFileBase::read_matrix(), mrpt::obs::gnss::gnss_message::readAndBuildFromStream(), mrpt::comms::CClientTCPSocket::readAsync(), mrpt::gui::CPanelCameraSelection::readConfigIntoVideoSourcePanel(), mrpt::opengl::CRenderizable::readFromStreamRender(), mrpt::serialization::CArchive::ReadObject(), mrpt::serialization::CArchive::ReadVariant(), mrpt::hwdrivers::CVelodyneScanner::receivePackets(), mrpt::opengl::COpenGLViewport::renderNormalSceneMode(), run_test_pf_localization(), mrpt::graphs::detail::graph_ops< graph_t >::save_graph_of_poses_to_text_file(), mrpt::vision::TSequenceFeatureObservations::saveToTextFile(), mrpt::obs::CObservationBearingRange::serializeFrom(), mrpt::obs::CObservationBearingRange::serializeTo(), mrpt::comms::CSerialPort::setConfig(), mrpt::nav::CAbstractPTGBasedReactive::setHolonomicMethod(), mrpt::hwdrivers::CSwissRanger3DCamera::setPathForExternalImages(), mrpt::hwdrivers::CCameraSensor::setPathForExternalImages(), mrpt::poses::CPoseRandomSampler::setPosePDF(), mrpt::comms::CSerialPort::setTimeouts(), mrpt::kinematics::CVehicleVelCmd_DiffDriven::setVelCmdElement(), mrpt::kinematics::CVehicleVelCmd_Holo::setVelCmdElement(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::setW(), mrpt::math::size(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::startSyncCapture(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateMapPartitionsVisualization(), mrpt::comms::CSerialPort::Write(), and mrpt::comms::CClientTCPSocket::writeAsync().

◆ THROW_STACKED_EXCEPTION

#define THROW_STACKED_EXCEPTION
Value:
std::throw_with_nested( \
"Called from here.", __FILE__, __LINE__, \
std::string exception_line_msg(const std::string_view &msg, const char *filename, unsigned int line, const char *function_name)
Definition: exceptions.cpp:16
#define __CURRENT_FUNCTION_NAME__
A macro for obtaining the name of the current function:
Definition: common.h:134
See also
MRPT_TRY_START, MRPT_TRY_END

Definition at line 79 of file exceptions.h.

Referenced by mrpt::hwdrivers::CImageGrabber_dc1394::enumerateCameras(), and TEST().

◆ THROW_STACKED_EXCEPTION_CUSTOM_MSG2

#define THROW_STACKED_EXCEPTION_CUSTOM_MSG2 (   stuff,
  param1 
)
Value:
std::throw_with_nested( \
mrpt::format(stuff, param1), __FILE__, __LINE__, \
std::string std::string format(std::string_view fmt, ARGS &&... args)
Definition: format.h:26
std::string exception_line_msg(const std::string_view &msg, const char *filename, unsigned int line, const char *function_name)
Definition: exceptions.cpp:16
#define __CURRENT_FUNCTION_NAME__
A macro for obtaining the name of the current function:
Definition: common.h:134

Definition at line 90 of file exceptions.h.

Referenced by mrpt::serialization::CArchive::internal_ReadObject(), mrpt::serialization::CArchive::internal_ReadObjectHeader(), and TEST().

◆ THROW_TYPED_EXCEPTION

#define THROW_TYPED_EXCEPTION (   msg,
  exceptionClass 
)
Value:
throw exceptionClass(mrpt::internal::exception_line_msg( \
msg, __FILE__, __LINE__, __CURRENT_FUNCTION_NAME__))
std::string exception_line_msg(const std::string_view &msg, const char *filename, unsigned int line, const char *function_name)
Definition: exceptions.cpp:16
#define __CURRENT_FUNCTION_NAME__
A macro for obtaining the name of the current function:
Definition: common.h:134

Definition at line 58 of file exceptions.h.

Referenced by mrpt::serialization::CArchive::internal_ReadObjectHeader().

◆ THROW_TYPED_EXCEPTION_FMT

#define THROW_TYPED_EXCEPTION_FMT (   exceptionClass,
  _FORMAT_STRING,
  ... 
)
Value:
mrpt::format(_FORMAT_STRING, __VA_ARGS__), exceptionClass)
#define THROW_TYPED_EXCEPTION(msg, exceptionClass)
Definition: exceptions.h:58
std::string std::string format(std::string_view fmt, ARGS &&... args)
Definition: format.h:26

Definition at line 72 of file exceptions.h.

Referenced by mrpt::img::CImage::makeSureImageIsLoaded().




Page generated by Doxygen 1.8.14 for MRPT 2.0.2 Git: 9b4fd2465 Mon May 4 16:59:08 2020 +0200 at lun may 4 17:26:07 CEST 2020