Go to the source code of this file.
Namespaces | |
mrpt | |
This is the global namespace for all Mobile Robot Programming Toolkit (MRPT) libraries. | |
Macros | |
#define | MRPT_CHECK_GCC_VERSION(major, minor) 0 |
MRPT_CHECK_GCC_VERSION(MAJ,MIN) More... | |
#define | MRPT_VISUALC_VERSION(major) 0 |
MRPT_CHECK_VISUALC_VERSION(Version) Version=8 for 2005, 9=2008, 10=2010, 11=2012, 12=2013, 14=2015. More... | |
#define | MRPT_CHECK_VISUALC_VERSION(major) 0 |
#define | __has_feature(x) 0 |
#define | __has_extension __has_feature |
#define | MRPT_HAS_CXX11 0 |
Does the compiler support C++11? More... | |
#define | MRPT_OVERRIDE |
C++11 "override" for virtuals: More... | |
#define | MRPT_DELETED_FUNC |
C++11 deleted function declarations. More... | |
#define | MRPT_NO_THROWS throw() |
C++11 noexcept: Used after member declarations. More... | |
#define | MRPT_HAS_UNIQUE_PTR 0 |
C++11 unique_ptr<> More... | |
#define | MRPT_DEPRECATED(msg) |
Usage: MRPT_DEPRECATED("Use XX instead") void myFunc(double);. More... | |
#define | MRPT_DO_PRAGMA(x) |
Declare MRPT_TODO(message) More... | |
#define | MRPT_MSG_PRAGMA(_msg) |
#define | MRPT_WARNING(x) MRPT_MSG_PRAGMA("Warning: " x) |
#define | MRPT_TODO(x) MRPT_MSG_PRAGMA("TODO: " x) |
#define | MRPT_printf_format_check(_FMT_, _VARARGS_) |
#define | MRPT_scanf_format_check(_FMT_, _VARARGS_) |
#define | MRPT_ALIGN16 |
#define | MRPT_ALIGN32 |
#define | __CURRENT_FUNCTION_NAME__ __PRETTY_FUNCTION__ |
A macro for obtaining the name of the current function: More... | |
#define | THROW_EXCEPTION(msg) |
#define | THROW_EXCEPTION_FMT(_FORMAT_STRING, ...) THROW_EXCEPTION(mrpt::format(_FORMAT_STRING,__VA_ARGS__)) |
#define | THROW_TYPED_EXCEPTION(msg, exceptionClass) |
Defines a unified way of reporting exceptions of type different than "std::exception". More... | |
#define | THROW_TYPED_EXCEPTION_FMT(exceptionClass, _FORMAT_STRING, ...) THROW_TYPED_EXCEPTION(mrpt::format(_FORMAT_STRING,__VA_ARGS__), exceptionClass) |
#define | THROW_STACKED_EXCEPTION(e) |
#define | THROW_STACKED_EXCEPTION_CUSTOM_MSG1(e, msg) |
#define | THROW_STACKED_EXCEPTION_CUSTOM_MSG2(e, stuff, param1) |
#define | MRPT_THROW_UNKNOWN_SERIALIZATION_VERSION(__V) THROW_EXCEPTION(mrpt::format("Cannot parse object: unknown serialization version number: '%i'",static_cast<int>(__V))) |
For use in CSerializable implementations. More... | |
#define | ASSERTMSG_(f, __ERROR_MSG) { } |
#define | ASSERT_(f) { } |
#define | MRPT_CHECK_NORMAL_NUMBER(val) { } |
#define | MRPT_COMPILE_TIME_ASSERT(f) { } |
#define | ASSERT_EQUAL_(__A, __B) { } |
#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 | ASSERT_FILE_EXISTS_(FIL) { } |
#define | ASSERT_DIRECTORY_EXISTS_(DIR) { } |
#define | ASSERTDEB_(f) { } |
Defines an assertion mechanism - only when compiled in debug. More... | |
#define | ASSERTDEBMSG_(f, __ERROR_MSG) { } |
#define | MRPT_UNUSED_PARAM(a) (void)(a) |
Can be used to avoid "not used parameters" warnings from the compiler. More... | |
#define | MRPT_TRY_START |
#define | MRPT_TRY_END |
#define | MRPT_TRY_END_WITH_CLEAN_UP(stuff) |
#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) |
#define | M_2PI 6.283185307179586476925286766559 |
#define | M_PIf 3.14159265358979f |
#define | M_2PIf 6.28318530717959f |
#define | MRPT_printf_format_check(_FMT_, _VARARGS_) |
#define | MRPT_scanf_format_check(_FMT_, _VARARGS_) |
#define | MRPT_FORCE_INLINE inline |
Tells the compiler we really want to inline that function. More... | |
#define | PRIuSIZE zu |
Format specifier for size_t variables in a OS-independent, processor architecture-independent way. More... | |
#define | QUOTE(name) #name |
#define | STR(macro) QUOTE(macro) |
#define | USIZE_STR STR(PRIuSIZE) |
#define | MRPT_MACROS_H |
#define | MRPT_CHECK_GCC_VERSION(major, minor) 0 |
#define | MRPT_VISUALC_VERSION(major) 0 |
#define | MRPT_CHECK_VISUALC_VERSION(major) 0 |
#define | MRPT_HAS_CXX11 0 |
#define | MRPT_OVERRIDE |
#define | MRPT_DELETED_FUNC |
#define | MRPT_NO_THROWS throw() |
#define | MRPT_HAS_UNIQUE_PTR 0 |
#define | MRPT_DEPRECATED(msg) |
#define | MRPT_DO_PRAGMA(x) |
#define | MRPT_MSG_PRAGMA(_msg) |
#define | MRPT_WARNING(x) MRPT_MSG_PRAGMA("Warning: " x) |
#define | MRPT_TODO(x) MRPT_MSG_PRAGMA("TODO: " x) |
#define | MRPT_printf_format_check(_FMT_, _VARARGS_) |
#define | MRPT_scanf_format_check(_FMT_, _VARARGS_) |
#define | MRPT_ALIGN16 |
#define | MRPT_ALIGN32 |
#define | __CURRENT_FUNCTION_NAME__ __PRETTY_FUNCTION__ |
#define | THROW_EXCEPTION(msg) |
#define | THROW_EXCEPTION_FMT(_FORMAT_STRING, ...) THROW_EXCEPTION(mrpt::format(_FORMAT_STRING,__VA_ARGS__)) |
#define | THROW_TYPED_EXCEPTION(msg, exceptionClass) |
#define | THROW_TYPED_EXCEPTION_FMT(exceptionClass, _FORMAT_STRING, ...) THROW_TYPED_EXCEPTION(mrpt::format(_FORMAT_STRING,__VA_ARGS__), exceptionClass) |
#define | THROW_STACKED_EXCEPTION(e) |
#define | THROW_STACKED_EXCEPTION_CUSTOM_MSG1(e, msg) |
#define | THROW_STACKED_EXCEPTION_CUSTOM_MSG2(e, stuff, param1) |
#define | MRPT_THROW_UNKNOWN_SERIALIZATION_VERSION(__V) THROW_EXCEPTION(mrpt::format("Cannot parse object: unknown serialization version number: '%i'",static_cast<int>(__V))) |
#define | ASSERTMSG_(f, __ERROR_MSG) { } |
#define | ASSERT_(f) { } |
#define | MRPT_CHECK_NORMAL_NUMBER(val) { } |
#define | MRPT_COMPILE_TIME_ASSERT(f) { } |
#define | ASSERT_EQUAL_(__A, __B) { } |
#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 | ASSERT_FILE_EXISTS_(FIL) { } |
#define | ASSERT_DIRECTORY_EXISTS_(DIR) { } |
#define | ASSERTDEB_(f) { } |
#define | ASSERTDEBMSG_(f, __ERROR_MSG) { } |
#define | MRPT_UNUSED_PARAM(a) (void)(a) |
#define | MRPT_TRY_START |
#define | MRPT_TRY_END |
#define | MRPT_TRY_END_WITH_CLEAN_UP(stuff) |
#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) |
#define | M_PIf 3.14159265358979f |
#define | M_2PIf 6.28318530717959f |
#define | MRPT_printf_format_check(_FMT_, _VARARGS_) |
#define | MRPT_scanf_format_check(_FMT_, _VARARGS_) |
#define | MRPT_FORCE_INLINE inline |
#define | PRIuSIZE zu |
#define | QUOTE(name) #name |
#define | STR(macro) QUOTE(macro) |
#define | USIZE_STR STR(PRIuSIZE) |
Functions | |
std::string BASE_IMPEXP | mrpt::format (const char *fmt,...) MRPT_printf_format_check(1 |
A std::string version of C sprintf. More... | |
#define __CURRENT_FUNCTION_NAME__ __PRETTY_FUNCTION__ |
A macro for obtaining the name of the current function:
Definition at line 146 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::optimize_graph_spa_levmarq().
#define __CURRENT_FUNCTION_NAME__ __PRETTY_FUNCTION__ |
#define __has_extension __has_feature |
Definition at line 43 of file mrpt_macros.h.
#define __has_feature | ( | x | ) | 0 |
Definition at line 40 of file mrpt_macros.h.
#define ASSERT_ | ( | f | ) | { } |
#define ASSERT_ | ( | f | ) | { } |
Definition at line 278 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::opengl::CMeshFast::adjustGridToImageAR(), mrpt::opengl::CMesh::adjustGridToImageAR(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::alignOpticalWithMRPTFrame(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::appendCol(), mrpt::opengl::CSetOfLines::appendLineStrip(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::appendRow(), mrpt::opengl::COctoMapVoxels::areVoxelsVisible(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::ASSERT_ENOUGHROOM(), 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(), CGraphSlamHandler< GRAPH_T >::CGraphSlamHandler(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::checkPartitionsForLC(), mrpt::math::CMatrixColumnAccessor< MAT >::CMatrixColumnAccessor(), mrpt::math::CMatrixColumnAccessorExtended< MAT >::CMatrixColumnAccessorExtended(), mrpt::math::CMatrixRowAccessor< MAT >::CMatrixRowAccessor(), mrpt::math::CMatrixRowAccessorExtended< MAT >::CMatrixRowAccessorExtended(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::CMatrixTemplate(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::math::confidenceIntervals(), mrpt::math::CHistogram::createWithFixedWidth(), mrpt::math::crossProduct3D(), mrpt::random::CRandomGenerator::drawGaussianMultivariate(), mrpt::math::estimateJacobian(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evalPWConsistenciesMatrix(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::exactBisection(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::execDijkstraProjection(), CGraphSlamHandler< GRAPH_T >::execute(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::extractSubGraph(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::fetchNodeIDsForScanMatching(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::fillNodePropsFromGroupParams(), mrpt::vision::find_descriptor_pairings(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::findPathByEnds(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistencyElement(), mrpt::math::ModelSearch::geneticSingleModel(), mrpt::maps::CBeaconMap::get(), mrpt::poses::CPointPDFSOG::get(), mrpt::poses::CPosePDFSOG::get(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::graphs::detail::TNodeAnnotations::getAnnotsAsString(), mrpt::utils::CMHPropertiesValuesList::getAs(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::graphslam::detail::TNodeProps< GRAPH_T >::getAsString(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TGetICPEdgeAdParams::getAsString(), mrpt::poses::CPose2DGridTemplate< double >::getByIndex(), mrpt::utils::CMessage::getContentAsStruct(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getCurrPartitions(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getDeformationEnergyVector(), mrpt::graphs::detail::THypothesis< GRAPH_T >::getEdge(), mrpt::utils::CMHPropertiesValuesList::getElemental(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getICPEdge(), mrpt::graphs::detail::THypothesis< GRAPH_T >::getInverseEdge(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::getLandmarkMean(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getMinUncertaintyPath(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getMostLikelyParticle(), mrpt::obs::CObservationGPS::getMsgByClass(), mrpt::nav::TMoveTree< NODE_TYPE_DATA, EDGE_TYPE, MAPS_IMPLEMENTATION >::getNearestNode(), mrpt::hmtslam::CHMHMapArc::getNodeFrom(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getNodeIDsOfEstimatedTrajectory(), mrpt::hmtslam::CHMHMapArc::getNodeTo(), CGraphSlamHandler< GRAPH_T >::getParamsAsString(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getParamsAsString(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getPropsOfNodeID(), 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::graphslam::CGraphSlamEngine< GRAPH_T >::getRobotEstimatedTrajectory(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::getShortestPathTo(), mrpt::opengl::CSetOfTexturedTriangles::getTriangle(), mrpt::opengl::CSetOfTriangles::getTriangle(), mrpt::maps::CLandmark::getType(), mrpt::math::CPolygon::GetVertex_x(), mrpt::math::CPolygon::GetVertex_y(), mrpt::opengl::COctoMapVoxels::getVoxelCount(), mrpt::math::homogeneousMatrixInverse(), mrpt::poses::CPose2DGridTemplate< double >::idx2phi(), mrpt::poses::CPose2DGridTemplate< double >::idx2x(), mrpt::poses::CPose2DGridTemplate< double >::idx2y(), 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::math::detail::VicinityTraits< CMatrixFixedNumeric< T, D, D > >::initialize(), 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::math::CMatrixTemplate< mrpt::math::TPoint3D >::insertCol(), mrpt::math::interpolate(), mrpt::math::KLD_Gaussians(), mrpt::math::leastSquareLinearFit(), mrpt::opengl::CPointCloud::loadFromPointsMap(), mrpt::math::mahalanobisDistance2(), mrpt::math::maximum(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::math::minimum(), mrpt::math::minimum_maximum(), mrpt::math::ncc_vector(), mrpt::graphslam::CRegistrationDeciderOrOptimizer< GRAPH_t >::notifyOfWindowEvents(), mrpt::slam::detail::TPathBin2D::lt_operator::operator()(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::operator()(), mrpt::utils::safe_ptr< mrpt::hmtslam::CHierarchicalMHMap >::operator*(), mrpt::utils::non_copiable_ptr< T >::operator*(), mrpt::utils::copiable_NULL_ptr< T >::operator*(), mrpt::utils::safe_ptr_basic< mrpt::hmtslam::CHierarchicalMHMap >::operator->(), mrpt::obs::gnss::gnss_message_ptr::operator->(), mrpt::utils::non_copiable_ptr_basic< void >::operator->(), mrpt::utils::ignored_copy_ptr< mrpt::maps::COctoMapBase >::operator->(), mrpt::utils::copiable_NULL_ptr_basic< T >::operator->(), mrpt::maps::CBeaconMap::operator[](), mrpt::utils::safe_ptr< mrpt::hmtslam::CHierarchicalMHMap >::operator[](), mrpt::poses::CPointPDFSOG::operator[](), mrpt::poses::CPosePDFSOG::operator[](), mrpt::utils::non_copiable_ptr< T >::operator[](), mrpt::utils::copiable_NULL_ptr< T >::operator[](), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::performSubstitution(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_gatherActionsCheckBothActObs(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_pfStandardProposal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::poses::CPose2DGridTemplate< double >::phi2idx(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::popMinUncertaintyPath(), mrpt::math::productIntegralAndMahalanobisTwoGaussians(), mrpt::math::productIntegralTwoGaussians(), mrpt::obs::detail::project3DPointsFromDepthImageInto(), mrpt::vision::pinhole::projectPoint_no_distortion(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::queryObserverForEvents(), mrpt::math::ModelSearch::ransacSingleModel(), mrpt::bayes::CRejectionSamplingCapable< mrpt::poses::CPose2D >::rejectionSampling(), mrpt::math::CBinaryRelation< T, U, UIsObject >::removeElementAt(), mrpt::nav::PlannerTPS_VirtualBase::renderMoveTree(), mrpt::opengl::COctoMapVoxels::reserveVoxels(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::resetPDF(), mrpt::opengl::COctoMapVoxels::resizeVoxels(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), CGraphSlamHandler< GRAPH_T >::saveResults(), mrpt::utils::CMemoryStream::setAllocBlockSize(), mrpt::maps::CPointsMap::setAllPointsTemplate(), mrpt::math::CSparseMatrix::setColCount(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::setCovMatrixAndMean(), mrpt::utils::TCamera::setDistortionParamsVector(), mrpt::utils::CImage::setFromRGBMatrices(), mrpt::opengl::CGridPlaneXZ::setGridFrequency(), mrpt::opengl::CGridPlaneXY::setGridFrequency(), mrpt::opengl::CVectorField3D::setPointCoordinates(), mrpt::math::CSparseMatrix::setRowCount(), mrpt::poses::CPose2DGridTemplate< double >::setSize(), mrpt::hwdrivers::CServoeNeck::setTruncateFactor(), mrpt::opengl::CVectorField2D::setVectorField(), mrpt::opengl::CVectorField3D::setVectorField(), mrpt::graphslam::CRegistrationDeciderOrOptimizer< GRAPH_t >::setWindowManagerPtr(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::opengl::COctoMapVoxels::showVoxels(), mrpt::math::skew_symmetric3(), mrpt::math::skew_symmetric3_neg(), mrpt::math::spline(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::math::detail::stub_kmeans(), 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::vision::TSIFTDescriptorsKDTreeIndex< distance_t, metric_t >::TSIFTDescriptorsKDTreeIndex(), mrpt::vision::TSURFDescriptorsKDTreeIndex< distance_t, metric_t >::TSURFDescriptorsKDTreeIndex(), mrpt::opengl::CSetOfTriangles::TTriangle::TTriangle(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateCurrCovarianceVisualization(), 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::deciders::CLoopCloserERD< GRAPH_T >::updateLaserScansVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateMapPartitionsVisualization(), 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::CRegistrationDeciderOrOptimizer< GRAPH_t >::updateVisuals(), mrpt::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), mrpt::poses::CPose2DGridTemplate< double >::x2idx(), and mrpt::poses::CPose2DGridTemplate< double >::y2idx().
#define ASSERT_ABOVE_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 284 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::optimize_graph_spa_levmarq(), and mrpt::nav::PlannerTPS_VirtualBase::renderMoveTree().
#define ASSERT_ABOVE_ | ( | __A, | |
__B | |||
) | { } |
#define ASSERT_ABOVEEQ_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 286 of file maps/CColouredPointsMap.h.
Referenced by mrpt::vision::find_descriptor_pairings(), mrpt::maps::COccupancyGridMap2D::getBasisCell(), mrpt::maps::COccupancyGridMap2D::getVoroniClearance(), mrpt::maps::COccupancyGridMap2D::setBasisCell(), mrpt::poses::CPose3D::setFromXYZQ(), and mrpt::maps::COccupancyGridMap2D::setVoroniClearance().
#define ASSERT_ABOVEEQ_ | ( | __A, | |
__B | |||
) | { } |
#define ASSERT_BELOW_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 283 of file maps/CColouredPointsMap.h.
Referenced by mrpt::opengl::COpenGLViewport::getLight(), mrpt::opengl::CPointCloudColoured::getPoint(), mrpt::opengl::CPointCloud::getPoint(), mrpt::maps::CPointsMap::getPointAllFields(), mrpt::opengl::CPointCloudColoured::getPointf(), mrpt::opengl::CPointCloud::getPointf(), mrpt::poses::CPose3D::inverseComposePoint(), mrpt::opengl::CPointCloudColoured::operator[](), mrpt::opengl::CPointCloud::operator[](), mrpt::math::CBinaryRelation< T, U, UIsObject >::operator[](), mrpt::maps::CPointsMap::setPoint(), and mrpt::maps::CPointsMap::setPointAllFields().
#define ASSERT_BELOW_ | ( | __A, | |
__B | |||
) | { } |
Referenced by mrpt::maps::CColouredPointsMap::setPoint().
#define ASSERT_BELOWEQ_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 285 of file maps/CColouredPointsMap.h.
Referenced by mrpt::math::detail::extractMatrix(), mrpt::maps::COccupancyGridMap2D::getBasisCell(), mrpt::maps::COccupancyGridMap2D::getVoroniClearance(), mrpt::maps::COccupancyGridMap2D::setBasisCell(), and mrpt::maps::COccupancyGridMap2D::setVoroniClearance().
#define ASSERT_BELOWEQ_ | ( | __A, | |
__B | |||
) | { } |
#define ASSERT_DIRECTORY_EXISTS_ | ( | DIR | ) | { } |
Definition at line 289 of file maps/CColouredPointsMap.h.
#define ASSERT_DIRECTORY_EXISTS_ | ( | DIR | ) | { } |
#define ASSERT_EQUAL_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 281 of file maps/CColouredPointsMap.h.
Referenced by mrpt::math::CMatrixTemplateNumeric< KFTYPE >::CMatrixTemplateNumeric(), mrpt::poses::CPose3D::CPose3D(), mrpt::random::CRandomGenerator::drawGaussianMultivariate(), mrpt::random::CRandomGenerator::drawGaussianMultivariateMany(), mrpt::poses::CPoint< CPoint3D >::fromString(), mrpt::math::multiply_A_skew3(), mrpt::math::multiply_skew3_A(), mrpt::math::operator*(), mrpt::math::operator*=(), mrpt::math::operator+(), mrpt::math::operator+=(), mrpt::math::operator-(), mrpt::utils::ContainerReadOnlyProxyAccessor< std::vector< int32_t > >::operator=(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::TRGBDInfoFileParams::parseFile(), mrpt::obs::detail::project3DPointsFromDepthImageInto(), mrpt::graphs::detail::graph_ops< graph_t >::read_graph_of_poses_from_binary_file(), mrpt::maps::CPointsMap::setAllPointsTemplate(), mrpt::kinematics::CKinematicChain::setConfiguration(), and mrpt::math::CSplineInterpolator1D::setXY().
#define ASSERT_EQUAL_ | ( | __A, | |
__B | |||
) | { } |
#define ASSERT_FILE_EXISTS_ | ( | FIL | ) | { } |
Definition at line 288 of file maps/CColouredPointsMap.h.
Referenced by mrpt::pbmap::config_heuristics::load_params(), and mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::TRGBDInfoFileParams::parseFile().
#define ASSERT_FILE_EXISTS_ | ( | FIL | ) | { } |
#define ASSERT_NOT_EQUAL_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 282 of file maps/CColouredPointsMap.h.
#define ASSERT_NOT_EQUAL_ | ( | __A, | |
__B | |||
) | { } |
#define ASSERTDEB_ | ( | f | ) | { } |
Defines an assertion mechanism - only when compiled in debug.
Definition at line 300 of file maps/CColouredPointsMap.h.
Referenced by mrpt::bayes::detail::addNewLandmarks(), mrpt::math::covariancesAndMeanWeighted(), mrpt::opengl::COctoMapVoxels::getGridCube(), mrpt::opengl::COctoMapVoxels::getGridCubeRef(), mrpt::opengl::COctoMapVoxels::getVoxel(), mrpt::opengl::COctoMapVoxels::getVoxelRef(), mrpt::math::homogeneousMatrixInverse(), 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(), mrpt::math::normalPDF(), mrpt::math::normalPDFInf(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::opengl::COctoMapVoxels::push_back_Voxel(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::maps::CSimplePointsMap::setPointAllFieldsFast(), mrpt::maps::CWeightedPointsMap::setPointAllFieldsFast(), mrpt::math::slerp(), mrpt::math::weightedHistogram(), and mrpt::math::weightedHistogramLog().
#define ASSERTDEB_ | ( | f | ) | { } |
Referenced by mrpt::mrpt::utils::DEG2RAD().
#define ASSERTDEBMSG_ | ( | f, | |
__ERROR_MSG | |||
) | { } |
Definition at line 301 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::optimize_graph_spa_levmarq().
#define ASSERTDEBMSG_ | ( | f, | |
__ERROR_MSG | |||
) | { } |
#define ASSERTMSG_ | ( | f, | |
__ERROR_MSG | |||
) | { } |
#define ASSERTMSG_ | ( | f, | |
__ERROR_MSG | |||
) | { } |
Definition at line 277 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::addVirtualEdge(), mrpt::graphslam::TUncertaintyPath< GRAPH_T >::assertIsBetweenNodeIDs(), mrpt::graphslam::CRegistrationDeciderOrOptimizer< GRAPH_t >::assertVisualsVars(), mrpt::poses::CPose3DQuat::iterator::check_limits(), mrpt::poses::CPose3DQuat::const_iterator::check_limits(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkRegistrationDeciderExists(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::connectGraphPartitions(), mrpt::math::covariancesAndMeanWeighted(), mrpt::math::CQuaternion< T >::CQuaternion(), mrpt::math::CSparseMatrix::CSparseMatrix(), 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::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpRegistrarsToConsole(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::execDijkstraProjection(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::extractSubGraph(), mrpt::vision::find_descriptor_pairings(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::fitGraphInView(), mrpt::poses::CPose3DQuat::fromString(), mrpt::poses::CPose3DRotVec::fromString(), mrpt::poses::CPose3D::fromString(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generateHypotsPool(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistenciesMatrix(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::generateReportFiles(), mrpt::graphs::detail::THypothesis< GRAPH_T >::getAsString(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::getEdgeSquareError(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getGraphSlamStats(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::getICPEdge(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getMinUncertaintyPath(), mrpt::obs::CObservationGPS::getMsgByClass(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getPropsOfNodeID(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getTimeStamp(), 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::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::math::meanAndCovMat(), mrpt::math::meanAndCovVec(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::math::ncc_vector(), mrpt::graphslam::TUncertaintyPath< GRAPH_T >::operator+=(), mrpt::math::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::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::save3DScene(), mrpt::kinematics::CVehicleSimul_Holo::sendVelCmd(), mrpt::kinematics::CVehicleSimul_DiffDriven::sendVelCmd(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::setCurrentPositionModel(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::math::detail::stub_kmeans(), 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().
#define M_2PI 6.283185307179586476925286766559 |
Definition at line 380 of file mrpt_macros.h.
Referenced by mrpt::math::covariancesAndMeanWeighted(), mrpt::utils::CEnhancedMetaFile::ellipseGaussian(), mrpt::utils::CCanvas::ellipseGaussian(), mrpt::math::mahalanobisDistance2AndLogPDF(), mrpt::math::normalPDF(), mrpt::math::normalPDFInf(), mrpt::math::productIntegralAndMahalanobisTwoGaussians(), mrpt::math::productIntegralTwoGaussians(), and mrpt::math::spline().
#define M_2PIf 6.28318530717959f |
Definition at line 384 of file maps/CColouredPointsMap.h.
#define M_2PIf 6.28318530717959f |
#define M_PIf 3.14159265358979f |
Definition at line 383 of file maps/CColouredPointsMap.h.
Referenced by mrpt::utils::DEG2RAD(), and mrpt::utils::RAD2DEG().
#define M_PIf 3.14159265358979f |
#define MRPT_ALIGN16 |
Definition at line 138 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::computeJacobiansAndErrors(), mrpt::obs::detail::do_project_3d_pointcloud_SSE2(), image_SSE2_scale_half_1c8u(), image_SSE2_scale_half_smooth_1c8u(), image_SSSE3_scale_half_3c8u(), mrpt::graphs::CDirectedGraph< CPOSE, EDGE_ANNOTATIONS >::insertEdge(), and mrpt::graphs::CDirectedGraph< CPOSE, EDGE_ANNOTATIONS >::insertEdgeAtEnd().
#define MRPT_ALIGN16 |
#define MRPT_ALIGN32 |
Definition at line 139 of file maps/CColouredPointsMap.h.
#define MRPT_ALIGN32 |
#define MRPT_CHECK_GCC_VERSION | ( | major, | |
minor | |||
) | 0 |
MRPT_CHECK_GCC_VERSION(MAJ,MIN)
Definition at line 21 of file maps/CColouredPointsMap.h.
#define MRPT_CHECK_GCC_VERSION | ( | major, | |
minor | |||
) | 0 |
#define MRPT_CHECK_NORMAL_NUMBER | ( | val | ) | { } |
#define MRPT_CHECK_NORMAL_NUMBER | ( | val | ) | { } |
Definition at line 279 of file maps/CColouredPointsMap.h.
Referenced by mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), and mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFStandard().
#define MRPT_CHECK_VISUALC_VERSION | ( | major | ) | 0 |
#define MRPT_CHECK_VISUALC_VERSION | ( | major | ) | 0 |
Definition at line 27 of file maps/CColouredPointsMap.h.
#define MRPT_COMPILE_TIME_ASSERT | ( | f | ) | { } |
Definition at line 280 of file maps/CColouredPointsMap.h.
Referenced by mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::CMatrixTemplate(), mrpt::math::loadVector(), mrpt::math::make_vector(), and mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::operator=().
#define MRPT_COMPILE_TIME_ASSERT | ( | f | ) | { } |
#define MRPT_DELETED_FUNC |
#define MRPT_DELETED_FUNC |
C++11 deleted function declarations.
Definition at line 65 of file maps/CColouredPointsMap.h.
Referenced by mrpt::utils::ContainerReadOnlyProxyAccessor< std::vector< int32_t > >::ContainerReadOnlyProxyAccessor().
#define MRPT_DEPRECATED | ( | msg | ) |
#define MRPT_DEPRECATED | ( | msg | ) |
Usage: MRPT_DEPRECATED("Use XX instead") void myFunc(double);.
Definition at line 95 of file maps/CColouredPointsMap.h.
Referenced by mrpt::nav::CAbstractPTGBasedReactive::TNavigationParamsPTG::clone(), mrpt::obs::CObservation3DRangeScan::project3DPointsFromDepthImage(), and mrpt::obs::CObservation3DRangeScan::project3DPointsFromDepthImageInto().
#define MRPT_DO_PRAGMA | ( | x | ) |
#define MRPT_DO_PRAGMA | ( | x | ) |
Declare MRPT_TODO(message)
Definition at line 110 of file maps/CColouredPointsMap.h.
#define MRPT_END MRPT_TRY_END |
#define MRPT_END MRPT_TRY_END |
Definition at line 370 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::_optimizeGraph(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::addScanMatchingEdges(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::addToPaths(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::alignOpticalWithMRPTFrame(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::checkForLoopClosures(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkOptimizerExists(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::checkPartitionsForLC(), 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::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::CLevMarqGSO(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeCentroidOfNodesVector(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeSlamMetric(), mrpt::math::confidenceIntervals(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::convert3DTo2DRangeScan(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::createDeciderOptimizerMappings(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::decimateLaserScan(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::decimatePointsMap(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpOptimizersToConsole(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpRegistrarsToConsole(), 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::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::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::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::ESS(), mrpt::math::estimateJacobian(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evalPWConsistenciesMatrix(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evaluatePartitionsForLC(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::execDijkstraProjection(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::vision::find_descriptor_pairings(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::fitGraphInView(), mrpt::math::generateAxisBaseFromDirection(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generateHypotsPool(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistenciesMatrix(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistencyElement(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::generateReportFiles(), mrpt::obs::CActionCollection::getActionByClass(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::utils::CMHPropertiesValuesList::getAs(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::getAsString(), mrpt::opengl::CSetOfObjects::getByClass(), mrpt::opengl::COpenGLScene::getByClass(), mrpt::opengl::COpenGLViewport::getByClass(), mrpt::utils::CMessage::getContentAsStruct(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getCurrentRobotPosEstimation(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getDeformationEnergyVector(), mrpt::graphslam::deciders::CNodeRegistrationDecider< 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::utils::CMHPropertiesValuesList::getElemental(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getGraphSlamStats(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::getICPEdge(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getICPEdge(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap(), 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::graphslam::CGraphSlamEngine< GRAPH_T >::getNodeIDsOfEstimatedTrajectory(), mrpt::obs::CSensoryFrame::getObservationByClass(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getParamsAsString(), mrpt::utils::CClientTCPSocket::getPosition(), mrpt::hwdrivers::CSerialPort::getPosition(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getRobotEstimatedTrajectory(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getTimeStamp(), mrpt::utils::CClientTCPSocket::getTotalBytesCount(), mrpt::hwdrivers::CSerialPort::getTotalBytesCount(), 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::math::homogeneousMatrixInverse(), 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::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::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >::insertPointCloud(), mrpt::math::interpolate(), 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::math::leastSquareLinearFit(), 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::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::loadFromConfigFile(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::loadFromConfigFile(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLaserParams::loadFromConfigFile(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLoopClosureParams::loadFromConfigFile(), mrpt::opengl::CPointCloud::loadFromPointsList(), mrpt::graphslam::deciders::CRangeScanEdgeRegistrationDecider< 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::deciders::CLoopCloserERD< GRAPH_T >::loadParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::loadParams(), mrpt::math::mahalanobisDistance2(), mrpt::math::mahalanobisDistance2AndLogPDF(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::mahalanobisDistanceOdometryToICPEdge(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::math::multiply_A_skew3(), mrpt::math::multiply_skew3_A(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::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::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::optimizeGraph(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::performSubstitution(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_pfStandardProposal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::popMinUncertaintyPath(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::populateDeciderOptimizerProperties(), mrpt::graphslam::deciders::CRangeScanEdgeRegistrationDecider< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::printParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::printParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::queryObserverForEvents(), mrpt::utils::CConfigFileBase::read_enum(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFileRGBD_TUM(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::readParticlesFromStream(), 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< mrpt::poses::CPose2D >::rejectionSampling(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::render_dl(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::resetPDF(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::save3DScene(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::saveGraph(), mrpt::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >::saveMetricMapRepresentationToFile(), mrpt::utils::CClientTCPSocket::Seek(), mrpt::hwdrivers::CSerialPort::Seek(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::setCovMatrixAndMean(), mrpt::utils::CImage::setFromMatrix(), mrpt::utils::CImage::setFromRGBMatrices(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::setObjectPropsFromNodeID(), mrpt::math::CSplineInterpolator1D::setXY(), mrpt::gui::CDisplayWindow::showImageAndPoints(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::gui::CDisplayWindow::showTiledImageAndPoints(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::math::detail::stub_kmeans(), 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::math::transform_gaussian_linear(), mrpt::math::transform_gaussian_montecarlo(), mrpt::math::transform_gaussian_unscented(), 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::graphslam::CGraphSlamEngine< GRAPH_T >::updateOdometryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateOptDistanceVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateRangeImageViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateSlamMetricVisualization(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::updateState(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaNRD< 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::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), and mrpt::bayes::CParticleFilterData< CRBPFParticleData >::writeParticlesToStream().
#define MRPT_END_WITH_CLEAN_UP | ( | stuff | ) | MRPT_TRY_END_WITH_CLEAN_UP(stuff) |
Definition at line 373 of file maps/CColouredPointsMap.h.
Referenced by mrpt::utils::CEnhancedMetaFile::ellipseGaussian(), mrpt::utils::CCanvas::ellipseGaussian(), and mrpt::utils::CMHPropertiesValuesList::setElemental().
#define MRPT_END_WITH_CLEAN_UP | ( | stuff | ) | MRPT_TRY_END_WITH_CLEAN_UP(stuff) |
#define MRPT_FORCE_INLINE inline |
Tells the compiler we really want to inline that function.
Definition at line 411 of file maps/CColouredPointsMap.h.
#define MRPT_FORCE_INLINE inline |
#define MRPT_HAS_CXX11 0 |
#define MRPT_HAS_CXX11 0 |
Does the compiler support C++11?
Definition at line 51 of file maps/CColouredPointsMap.h.
#define MRPT_HAS_UNIQUE_PTR 0 |
#define MRPT_HAS_UNIQUE_PTR 0 |
C++11 unique_ptr<>
Definition at line 79 of file maps/CColouredPointsMap.h.
#define MRPT_MACROS_H |
Definition at line 12 of file maps/CColouredPointsMap.h.
#define MRPT_MSG_PRAGMA | ( | _msg | ) |
#define MRPT_MSG_PRAGMA | ( | _msg | ) |
Definition at line 111 of file maps/CColouredPointsMap.h.
#define MRPT_NO_THROWS throw() |
#define MRPT_NO_THROWS throw() |
C++11 noexcept: Used after member declarations.
Definition at line 72 of file maps/CColouredPointsMap.h.
Referenced by mrpt::math::absDiff(), mrpt::system::createThreadFromObjectMethod(), mrpt::utils::CImage::forceLoad(), mrpt::utils::CImage::getSize(), and mrpt::math::hypot_fast().
#define MRPT_OVERRIDE |
Referenced by mrpt::mrpt::utils::fix().
#define MRPT_OVERRIDE |
C++11 "override" for virtuals:
Definition at line 58 of file maps/CColouredPointsMap.h.
Referenced by mrpt::opengl::CGeneralizedCylinder::addVisibleSectionAtEnd(), mrpt::opengl::CMesh::adjustGridToImageAR(), mrpt::poses::CPose3DPDFGaussian::asString(), mrpt::maps::CReflectivityGridMap2D::cell2float(), mrpt::vision::CFeatureTracker_KL::CFeatureTracker_KL(), mrpt::nav::CAbstractPTGBasedReactive::changeCurrentRobotSpeedLimits(), mrpt::maps::TSetOfMetricMapInitializers::clear(), mrpt::nav::CWaypointsNavigator::TNavigationParamsWaypoints::clone(), mrpt::opengl::CRenderizableDisplayList::clone(), mrpt::nav::CAbstractPTGBasedReactive::TNavigationParamsPTG::clone(), mrpt::nav::CAbstractNavigator::TNavigationParams::clone(), mrpt::nav::CPTG_DiffDrive_alpha::CPTG_DiffDrive_alpha(), mrpt::nav::CPTG_DiffDrive_C::CPTG_DiffDrive_C(), mrpt::nav::CPTG_DiffDrive_CC::CPTG_DiffDrive_CC(), mrpt::nav::CPTG_DiffDrive_CCS::CPTG_DiffDrive_CCS(), mrpt::nav::CPTG_DiffDrive_CS::CPTG_DiffDrive_CS(), mrpt::opengl::CSetOfObjects::empty(), mrpt::poses::CPointPDFSOG::empty(), mrpt::maps::CPointsMap::empty(), mrpt::gui::CDisplayWindow::enableCursorCoordinatesVisualization(), mrpt::opengl::C3DSScene::enableExtraAmbientLight(), mrpt::opengl::CSetOfTriangles::enableTransparency(), mrpt::opengl::CAngularObservationMesh::enableTransparency(), mrpt::obs::CObservationRange::end(), mrpt::poses::CPose3DPDFSOG::end(), mrpt::poses::CPosePDFSOG::erase(), mrpt::utils::CImage::getAs(), mrpt::maps::CSimplePointsMap::getAsSimplePointsMap(), mrpt::utils::CConfigFile::getAssociatedFile(), mrpt::obs::gnss::Message_TOPCON_PZS::getAsStruct(), mrpt::obs::gnss::Message_NMEA_GGA::getAsStruct(), mrpt::obs::gnss::getAsStruct(), mrpt::graphs::CDirectedTree< EDGE_TYPE >::getAsTextDescription(), mrpt::maps::CWirelessPowerGridMap2D::getCommonInsertOptions(), mrpt::maps::CHeightGridMap2D_MRF::getCommonInsertOptions(), mrpt::maps::CGasConcentrationGridMap2D::getCommonInsertOptions(), mrpt::utils::CConfigFileMemory::getContent(), mrpt::poses::CPoint2DPDFGaussian::getCovarianceAndMean(), mrpt::poses::CPosePDFGaussian::getCovarianceAndMean(), mrpt::opengl::CText::getFont(), mrpt::opengl::CGridPlaneXZ::getGridFrequency(), mrpt::opengl::CGridPlaneXY::getGridFrequency(), mrpt::utils::CEnhancedMetaFile::getHeight(), mrpt::poses::CPose3DQuatPDFGaussianInf::getInformationMatrix(), mrpt::poses::CPosePDFGaussianInf::getInformationMatrix(), mrpt::poses::CPose3DPDFGaussianInf::getInformationMatrix(), mrpt::opengl::CSimpleLine::getLineCoords(), mrpt::opengl::CEllipsoid::getLineWidth(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::getMax_W(), mrpt::nav::CPTG_Holo_Blend::getMaxAngVel(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::getMaxAngVel(), mrpt::obs::CObservationRFID::getNtags(), mrpt::opengl::CTexturedPlane::getPlaneCorners(), mrpt::poses::CPose3DQuatPDFGaussian::getPoseMean(), mrpt::poses::CPose2D::getPoseMean(), mrpt::poses::CPose3DRotVec::getPoseMean(), mrpt::nav::CReactiveNavigationSystem::getPTG(), mrpt::nav::CReactiveNavigationSystem3D::getPTG(), mrpt::nav::CPTG_RobotShape_Polygonal::getRobotShape(), mrpt::nav::CPTG_RobotShape_Circular::getRobotShapeRadius(), mrpt::opengl::CVectorField2D::getRowCount(), mrpt::opengl::CVectorField3D::getRowCount(), mrpt::obs::CObservationStereoImagesFeatures::getSensorPose(), mrpt::opengl::CCylinder::getStacksCount(), mrpt::opengl::CEllipsoidInverseDepth2D::getUnderflowMaxRange(), mrpt::opengl::CEllipsoidInverseDepth3D::getUnderflowMaxRange(), mrpt::opengl::CFrustum::getVertFOVUp(), mrpt::maps::CColouredOctoMap::getVoxelColourMethod(), mrpt::graphs::detail::graph_ops< graph_t >::graph_of_poses_dijkstra_init(), mrpt::opengl::CSetOfObjects::insert(), mrpt::opengl::CSetOfTexturedTriangles::insertTriangle(), mrpt::gui::CDisplayWindowPlots::internal_plot_interface(), mrpt::utils::CFileInputStream::is_open(), mrpt::utils::CFileGZInputStream::is_open(), mrpt::utils::CFileOutputStream::is_open(), mrpt::utils::CFileStream::is_open(), mrpt::opengl::CPointCloudColoured::isPointSmoothEnabled(), mrpt::opengl::CPointCloud::isPointSmoothEnabled(), mrpt::poses::CPose3D::ln(), mrpt::opengl::CAngularObservationMesh::TDoubleRange::negToPos(), mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::TInsertionOptions::operator=(), mrpt::opengl::CPointCloud::PLY_export_get_face_count(), mrpt::opengl::CPointCloudColoured::PLY_export_get_face_count(), mrpt::maps::CPointsMap::PLY_export_get_face_count(), mrpt::opengl::CPointCloud::PLY_import_set_face_count(), mrpt::opengl::CPointCloudColoured::PLY_import_set_face_count(), mrpt::maps::CPointsMap::PLY_import_set_face_count(), mrpt::nav::CAbstractPTGBasedReactive::PTGTarget::PTGTarget(), mrpt::maps::CBeaconMap::push_back(), mrpt::opengl::COctoMapVoxels::push_back_Voxel(), mrpt::utils::CStdOutStream::Read(), mrpt::opengl::CSetOfTriangles::rend(), mrpt::opengl::CSetOfLines::rend(), mrpt::opengl::CCamera::render(), mrpt::poses::CPoint2D::resize(), mrpt::poses::CPoint3D::resize(), mrpt::utils::CImage::resize(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::opengl::CArrow::setArrowYawPitchRoll(), mrpt::nav::CParameterizedTrajectoryGenerator::setClearanceDecimatedPaths(), mrpt::opengl::CSetOfLines::setLineByIndex(), mrpt::maps::CMultiMetricMap::setListOfMaps(), mrpt::opengl::CDisk::setLoopsCount(), mrpt::maps::CPointsMap::setPointAllFields(), mrpt::maps::CSimplePointsMap::setPointAllFieldsFast(), mrpt::maps::CWeightedPointsMap::setPointAllFieldsFast(), mrpt::opengl::CMesh3D::setPointSize(), mrpt::maps::COccupancyGridMap2D::setRawCell(), mrpt::opengl::CPlanarLaserScan::setScan(), mrpt::obs::CObservationReflectivity::setSensorPose(), mrpt::obs::CObservationComment::setSensorPose(), mrpt::obs::CObservationOdometry::setSensorPose(), mrpt::obs::CObservationVisualLandmarks::setSensorPose(), mrpt::obs::CObservationImage::setSensorPose(), mrpt::obs::CObservationRawDAQ::setSensorPose(), mrpt::obs::CObservationCANBusJ1939::setSensorPose(), mrpt::obs::CObservationSkeleton::setSensorPose(), mrpt::obs::CObservationBearingRange::setSensorPose(), mrpt::obs::CObservationRGBD360::setSensorPose(), mrpt::obs::CObservationIMU::setSensorPose(), mrpt::obs::CObservationStereoImages::setSensorPose(), mrpt::obs::CObservationGPS::setSensorPose(), mrpt::obs::CObservation2DRangeScan::setSensorPose(), mrpt::obs::CObservationVelodyneScan::setSensorPose(), mrpt::obs::CObservation3DRangeScan::setSensorPose(), mrpt::opengl::CText3D::setTextKerning(), mrpt::opengl::CMeshFast::setYBounds(), mrpt::opengl::CMesh::setYBounds(), mrpt::opengl::CSphere::should_skip_display_list_cache(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::poses::CPose3DPDFParticles::size(), mrpt::poses::CPointPDFParticles::size(), mrpt::poses::CPosePDFParticles::size(), mrpt::vision::TMultiResDescMatchOptions::TMultiResDescMatchOptions(), mrpt::vision::TMultiResDescOptions::TMultiResDescOptions(), mrpt::gui::CDisplayWindow3D::updateWindow(), mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::TLikelihoodOptions::~TLikelihoodOptions(), and mrpt::maps::CPointsMap::TLikelihoodOptions::~TLikelihoodOptions().
#define MRPT_printf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
Definition at line 396 of file maps/CColouredPointsMap.h.
Referenced by mrpt::utils::CStream::ReadAsAndCastTo(), and mrpt::utils::CDebugOutputCapable::~CDebugOutputCapable().
#define MRPT_printf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
#define MRPT_printf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
Definition at line 396 of file maps/CColouredPointsMap.h.
#define MRPT_printf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
#define MRPT_PROFILE_FUNC_START |
Definition at line 359 of file maps/CColouredPointsMap.h.
#define MRPT_PROFILE_FUNC_START |
#define MRPT_scanf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
Definition at line 403 of file maps/CColouredPointsMap.h.
#define MRPT_scanf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
#define MRPT_scanf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
#define MRPT_scanf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
Definition at line 403 of file maps/CColouredPointsMap.h.
#define MRPT_START |
#define MRPT_START |
Definition at line 366 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::_optimizeGraph(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::addScanMatchingEdges(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::addToPaths(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::alignOpticalWithMRPTFrame(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::checkForLoopClosures(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkOptimizerExists(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::checkPartitionsForLC(), 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::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::CLevMarqGSO(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeCentroidOfNodesVector(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeSlamMetric(), mrpt::math::confidenceIntervals(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::convert3DTo2DRangeScan(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::createDeciderOptimizerMappings(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::decimateLaserScan(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::decimatePointsMap(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpOptimizersToConsole(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpRegistrarsToConsole(), 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::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::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::utils::CEnhancedMetaFile::ellipseGaussian(), mrpt::utils::CCanvas::ellipseGaussian(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::ESS(), mrpt::math::estimateJacobian(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evalPWConsistenciesMatrix(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evaluatePartitionsForLC(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::execDijkstraProjection(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::vision::find_descriptor_pairings(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::fitGraphInView(), mrpt::math::generateAxisBaseFromDirection(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generateHypotsPool(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistenciesMatrix(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generatePWConsistencyElement(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::generateReportFiles(), mrpt::obs::CActionCollection::getActionByClass(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::utils::CMHPropertiesValuesList::getAs(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::getAsString(), mrpt::opengl::CSetOfObjects::getByClass(), mrpt::opengl::COpenGLScene::getByClass(), mrpt::opengl::COpenGLViewport::getByClass(), mrpt::utils::CMessage::getContentAsStruct(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getCurrentRobotPosEstimation(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getDeformationEnergyVector(), mrpt::graphslam::deciders::CNodeRegistrationDecider< 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::utils::CMHPropertiesValuesList::getElemental(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getGraphSlamStats(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::getICPEdge(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getICPEdge(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap(), 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::graphslam::CGraphSlamEngine< GRAPH_T >::getNodeIDsOfEstimatedTrajectory(), mrpt::obs::CSensoryFrame::getObservationByClass(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getParamsAsString(), mrpt::utils::CClientTCPSocket::getPosition(), mrpt::hwdrivers::CSerialPort::getPosition(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getRobotEstimatedTrajectory(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getTimeStamp(), mrpt::utils::CClientTCPSocket::getTotalBytesCount(), mrpt::hwdrivers::CSerialPort::getTotalBytesCount(), 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::math::homogeneousMatrixInverse(), 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::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::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >::insertPointCloud(), mrpt::math::interpolate(), 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::math::leastSquareLinearFit(), 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::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::loadFromConfigFile(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::loadFromConfigFile(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::loadFromConfigFile(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLaserParams::loadFromConfigFile(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLoopClosureParams::loadFromConfigFile(), mrpt::opengl::CPointCloud::loadFromPointsList(), mrpt::graphslam::deciders::CRangeScanEdgeRegistrationDecider< 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::deciders::CLoopCloserERD< GRAPH_T >::loadParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::loadParams(), mrpt::math::mahalanobisDistance2(), mrpt::math::mahalanobisDistance2AndLogPDF(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::mahalanobisDistanceOdometryToICPEdge(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::math::multiply_A_skew3(), mrpt::math::multiply_skew3_A(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::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::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::optimizeGraph(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::performSubstitution(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_pfStandardProposal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::popMinUncertaintyPath(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::populateDeciderOptimizerProperties(), mrpt::graphslam::deciders::CRangeScanEdgeRegistrationDecider< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::printParams(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::printParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::printParams(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::queryObserverForEvents(), mrpt::utils::CConfigFileBase::read_enum(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFileRGBD_TUM(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::readParticlesFromStream(), 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< mrpt::poses::CPose2D >::rejectionSampling(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::render_dl(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::resetPDF(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::save3DScene(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::saveGraph(), mrpt::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >::saveMetricMapRepresentationToFile(), mrpt::utils::CClientTCPSocket::Seek(), mrpt::hwdrivers::CSerialPort::Seek(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::setCovMatrixAndMean(), mrpt::utils::CMHPropertiesValuesList::setElemental(), mrpt::utils::CImage::setFromMatrix(), mrpt::utils::CImage::setFromRGBMatrices(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::setObjectPropsFromNodeID(), mrpt::math::CSplineInterpolator1D::setXY(), mrpt::gui::CDisplayWindow::showImageAndPoints(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::gui::CDisplayWindow::showTiledImageAndPoints(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::math::detail::stub_kmeans(), 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::math::transform_gaussian_linear(), mrpt::math::transform_gaussian_montecarlo(), mrpt::math::transform_gaussian_unscented(), 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::graphslam::CGraphSlamEngine< GRAPH_T >::updateOdometryVisualization(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateOptDistanceVisualization(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateRangeImageViewport(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::updateSlamMetricVisualization(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::updateState(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaNRD< 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::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), and mrpt::bayes::CParticleFilterData< CRBPFParticleData >::writeParticlesToStream().
#define MRPT_THROW_UNKNOWN_SERIALIZATION_VERSION | ( | __V | ) | THROW_EXCEPTION(mrpt::format("Cannot parse object: unknown serialization version number: '%i'",static_cast<int>(__V))) |
#define MRPT_THROW_UNKNOWN_SERIALIZATION_VERSION | ( | __V | ) | THROW_EXCEPTION(mrpt::format("Cannot parse object: unknown serialization version number: '%i'",static_cast<int>(__V))) |
For use in CSerializable implementations.
Definition at line 217 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphs::detail::graph_ops< graph_t >::read_graph_of_poses_from_binary_file(), mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::TLikelihoodOptions::readFromStream(), mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::TRenderingOptions::readFromStream(), and mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::thisclass_readFromStream().
#define MRPT_TODO | ( | x | ) | MRPT_MSG_PRAGMA("TODO: " x) |
#define MRPT_TODO | ( | x | ) | MRPT_MSG_PRAGMA("TODO: " x) |
Definition at line 115 of file maps/CColouredPointsMap.h.
#define MRPT_TRY_END |
#define MRPT_TRY_END |
Definition at line 352 of file maps/CColouredPointsMap.h.
Referenced by mrpt::opengl::graph_tools::graph_visualize().
#define MRPT_TRY_END_WITH_CLEAN_UP | ( | stuff | ) |
#define MRPT_TRY_END_WITH_CLEAN_UP | ( | stuff | ) |
Definition at line 353 of file maps/CColouredPointsMap.h.
#define MRPT_TRY_START |
Definition at line 351 of file maps/CColouredPointsMap.h.
Referenced by mrpt::opengl::graph_tools::graph_visualize().
#define MRPT_TRY_START |
#define MRPT_UNUSED_PARAM | ( | a | ) | (void)(a) |
#define MRPT_UNUSED_PARAM | ( | a | ) | (void)(a) |
Can be used to avoid "not used parameters" warnings from the compiler.
Definition at line 307 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::_optimizeGraph(), mrpt::maps::CSimplePointsMap::addFrom_classSpecific(), mrpt::utils::CArray< T, 0 >::at(), mrpt::utils::CDynamicGrid< TRandomFieldCell >::cell2float(), mrpt::poses::CPose3DQuat::iterator::check_limits(), mrpt::poses::CPose3DQuat::const_iterator::check_limits(), mrpt::utils::CImage::CImage(), mrpt::graphslam::computeJacobiansAndErrors(), mrpt::graphslam::detail::AuxErrorEval< CPose2D, gst >::computePseudoLnError(), mrpt::graphslam::detail::AuxErrorEval< CPose3D, gst >::computePseudoLnError(), mrpt::graphslam::detail::AuxErrorEval< CPose3DPDFGaussianInf, gst >::computePseudoLnError(), mrpt::hmtslam::CTopLCDetectorBase::computeSSOBetweenObservations(), mrpt::poses::CPose3DRotVec::CPose3DRotVec(), mrpt::bayes::CParticleFilterCapable::defaultEvaluator(), mrpt::utils::detail::PointCloudAdapterHelperNoRGB< POINTMAPTYPE, coords_t >::getPointRGBf(), mrpt::utils::detail::PointCloudAdapterHelperNoRGB< POINTMAPTYPE, coords_t >::getPointRGBu8(), mrpt::maps::CPointsMap::getPointWeight(), mrpt::graphs::detail::graph_ops< graph_t >::graph_of_poses_dijkstra_init(), mrpt::maps::CPointsMap::insertPoint(), mrpt::maps::CMetricMap::internal_canComputeObservationLikelihood(), mrpt::vision::TSimpleFeatureList_templ< TSimpleFeature >::isPointFeature(), mrpt::math::jacobians::jacob_yawpitchroll_from_quat(), mrpt::vision::CFeatureListKDTree< FEAT >::kdtree_distance(), mrpt::vision::CFeatureList::kdtree_distance(), mrpt::vision::CFeatureListKDTree< FEAT >::kdtree_get_bbox(), mrpt::vision::CFeatureList::kdtree_get_bbox(), mrpt::graphslam::detail::AuxErrorEval< CPose2D, gst >::multiply_Jt_W_err(), mrpt::graphslam::detail::AuxErrorEval< CPose3D, gst >::multiply_Jt_W_err(), mrpt::graphslam::detail::AuxErrorEval< CPose2D, gst >::multiplyJ1tLambdaJ2(), mrpt::graphslam::detail::AuxErrorEval< CPose3D, gst >::multiplyJ1tLambdaJ2(), mrpt::graphslam::detail::AuxErrorEval< CPose2D, gst >::multiplyJtLambdaJ(), mrpt::graphslam::detail::AuxErrorEval< CPose3D, gst >::multiplyJtLambdaJ(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnNewLandmarkAddedToMap(), mrpt::hmtslam::CTopLCDetectorBase::OnNewPose(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnObservationJacobians(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnPreComputingPredictions(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnTransitionJacobian(), mrpt::utils::CArray< T, 0 >::operator=(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_doWeHaveValidObservations(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::opengl::CPointCloud::PLY_import_set_face_count(), mrpt::opengl::CPointCloudColoured::PLY_import_set_face_count(), mrpt::maps::CPointsMap::PLY_import_set_face_count(), mrpt::utils::CStdOutStream::Read(), mrpt::utils::CStdOutStream::Seek(), mrpt::utils::CFileGZInputStream::Seek(), mrpt::utils::CClientTCPSocket::Seek(), mrpt::hwdrivers::CSerialPort::Seek(), mrpt::hwdrivers::CGenericSensor::setPathForExternalImages(), mrpt::maps::CPointsMap::setPoint(), mrpt::utils::detail::PointCloudAdapterHelperNoRGB< POINTMAPTYPE, coords_t >::setPointRGBf(), mrpt::utils::detail::PointCloudAdapterHelperNoRGB< POINTMAPTYPE, coords_t >::setPointRGBu8(), mrpt::maps::CPointsMap::setPointWeight(), mrpt::utils::detail::PointCloudAdapterHelperNoRGB< POINTMAPTYPE, coords_t >::setPointXYZ_RGBf(), mrpt::utils::detail::PointCloudAdapterHelperNoRGB< POINTMAPTYPE, coords_t >::setPointXYZ_RGBu8(), mrpt::hwdrivers::CPtuDPerception::status(), mrpt::math::detail::stub_kmeans(), mrpt::utils::CArray< T, 0 >::swap(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::traceRay(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::updateState(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::updateState(), and mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateState().
#define MRPT_VISUALC_VERSION | ( | major | ) | 0 |
MRPT_CHECK_VISUALC_VERSION(Version) Version=8 for 2005, 9=2008, 10=2010, 11=2012, 12=2013, 14=2015.
Definition at line 26 of file maps/CColouredPointsMap.h.
#define MRPT_VISUALC_VERSION | ( | major | ) | 0 |
#define MRPT_WARNING | ( | x | ) | MRPT_MSG_PRAGMA("Warning: " x) |
Definition at line 114 of file maps/CColouredPointsMap.h.
#define MRPT_WARNING | ( | x | ) | MRPT_MSG_PRAGMA("Warning: " x) |
#define PRIuSIZE zu |
#define PRIuSIZE zu |
Format specifier for size_t variables in a OS-independent, processor architecture-independent way.
See https://stackoverflow.com/questions/40202990/print-a-size-t-in-a-os-independent-architecture-independent-way for the initial post
Definition at line 424 of file maps/CColouredPointsMap.h.
#define QUOTE | ( | name | ) | #name |
Definition at line 426 of file maps/CColouredPointsMap.h.
#define QUOTE | ( | name | ) | #name |
#define STR | ( | macro | ) | QUOTE(macro) |
Definition at line 427 of file maps/CColouredPointsMap.h.
#define STR | ( | macro | ) | QUOTE(macro) |
#define THROW_EXCEPTION | ( | msg | ) |
msg | This can be a char*, a std::string, or a literal string. Defines a unified way of reporting exceptions |
Definition at line 154 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::poses::CPose3DQuat::iterator::check_limits(), mrpt::poses::CPose3DQuat::const_iterator::check_limits(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::checkRegistrationCondition3D(), mrpt::hmtslam::CHMTSLAM::CHMTSLAM(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::CMatrixTemplate(), mrpt::graphs::detail::CMRVisualizer< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::CMRVisualizer(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::utils::bimap< mrpt::maps::CLandmark::TLandmarkID, unsigned int >::direct(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::exactBisection(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::extractCol(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::extractSubmatrix(), mrpt::vision::find_descriptor_pairings(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::findPathByEnds(), mrpt::math::CQuaternion< T >::fromRodriguesVector(), mrpt::poses::CPoint< CPoint3D >::fromString(), mrpt::poses::CPose3DQuat::fromString(), mrpt::poses::CPose3DRotVec::fromString(), mrpt::poses::CPose3D::fromString(), mrpt::math::generateAxisBaseFromDirection(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::get_unsafe(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::get_unsafe_row(), mrpt::utils::CMHPropertiesValuesList::getAs(), mrpt::graphs::CDirectedGraph< CPOSE, EDGE_ANNOTATIONS >::getEdge(), mrpt::utils::CMHPropertiesValuesList::getElemental(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::getNodeDistanceToRoot(), mrpt::utils::CStdOutStream::getPosition(), mrpt::utils::CClientTCPSocket::getPosition(), mrpt::hwdrivers::CSerialPort::getPosition(), mrpt::utils::CStdOutStream::getTotalBytesCount(), mrpt::utils::CClientTCPSocket::getTotalBytesCount(), mrpt::hwdrivers::CSerialPort::getTotalBytesCount(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initClass(), mrpt::math::CSparseMatrix::insert_submatrix(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::insertCol(), mrpt::utils::bimap< mrpt::maps::CLandmark::TLandmarkID, unsigned int >::inverse(), mrpt::math::jacobians::jacob_yawpitchroll_from_quat(), 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::graphs::detail::graph_ops< graph_t >::load_graph_of_poses_from_text_file(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::utils::non_copiable_ptr_basic< void >::non_copiable_ptr_basic(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::hwdrivers::CSerialPort::open(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::operator()(), mrpt::utils::non_copiable_ptr_basic< void >::operator=(), mrpt::utils::non_copiable_ptr< T >::operator=(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::operator=(), mrpt::hmtslam::CHMTSLAM::operator=(), mrpt::math::TObject3D::operator=(), mrpt::utils::operator>>(), mrpt::utils::operator[](), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_gatherActionsCheckBothActObs(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_pfStandardProposal(), mrpt::utils::CStdOutStream::Read(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFile(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::math::round2up(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::utils::CStdOutStream::Seek(), mrpt::utils::CFileGZInputStream::Seek(), mrpt::utils::CClientTCPSocket::Seek(), mrpt::hwdrivers::CSerialPort::Seek(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::set_unsafe(), mrpt::utils::PointCloudAdapter< mrpt::maps::CSimplePointsMap >::setInvalidPoint(), mrpt::utils::PointCloudAdapter< mrpt::opengl::CPointCloudColoured >::setInvalidPoint(), mrpt::utils::PointCloudAdapter< mrpt::opengl::CPointCloud >::setInvalidPoint(), mrpt::utils::PointCloudAdapter< mrpt::obs::CObservation3DRangeScan >::setInvalidPoint(), mrpt::hwdrivers::CSerialPort::setSerialPortName(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::SpectralBisection(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::traceRay(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateState(), and mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::updateState3D().
#define THROW_EXCEPTION | ( | msg | ) |
#define THROW_EXCEPTION_FMT | ( | _FORMAT_STRING, | |
... | |||
) | THROW_EXCEPTION(mrpt::format(_FORMAT_STRING,__VA_ARGS__)) |
Definition at line 163 of file maps/CColouredPointsMap.h.
Referenced by mrpt::utils::CConsoleRedirector::CConsoleRedirector(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::CDijkstra(), mrpt::utils::CMHPropertiesValuesList::getElemental(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::getW(), mrpt::utils::CTextFileLinesParser::open(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::operator()(), mrpt::utils::CConfigFileBase::read_enum(), mrpt::utils::CConfigFileBase::read_matrix(), mrpt::graphs::detail::graph_ops< graph_t >::save_graph_of_poses_to_text_file(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::setW(), and mrpt::math::size().
#define THROW_EXCEPTION_FMT | ( | _FORMAT_STRING, | |
... | |||
) | THROW_EXCEPTION(mrpt::format(_FORMAT_STRING,__VA_ARGS__)) |
#define THROW_STACKED_EXCEPTION | ( | e | ) |
#define THROW_STACKED_EXCEPTION | ( | e | ) |
Definition at line 185 of file maps/CColouredPointsMap.h.
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG1 | ( | e, | |
msg | |||
) |
Definition at line 196 of file maps/CColouredPointsMap.h.
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG1 | ( | e, | |
msg | |||
) |
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG2 | ( | e, | |
stuff, | |||
param1 | |||
) |
Definition at line 208 of file maps/CColouredPointsMap.h.
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG2 | ( | e, | |
stuff, | |||
param1 | |||
) |
#define THROW_TYPED_EXCEPTION | ( | msg, | |
exceptionClass | |||
) |
#define THROW_TYPED_EXCEPTION | ( | msg, | |
exceptionClass | |||
) |
Defines a unified way of reporting exceptions of type different than "std::exception".
Definition at line 170 of file maps/CColouredPointsMap.h.
#define THROW_TYPED_EXCEPTION_FMT | ( | exceptionClass, | |
_FORMAT_STRING, | |||
... | |||
) | THROW_TYPED_EXCEPTION(mrpt::format(_FORMAT_STRING,__VA_ARGS__), exceptionClass) |
#define THROW_TYPED_EXCEPTION_FMT | ( | exceptionClass, | |
_FORMAT_STRING, | |||
... | |||
) | THROW_TYPED_EXCEPTION(mrpt::format(_FORMAT_STRING,__VA_ARGS__), exceptionClass) |
Definition at line 179 of file maps/CColouredPointsMap.h.
Definition at line 428 of file maps/CColouredPointsMap.h.
Page generated by Doxygen 1.8.13 for MRPT 1.5.3 at Sun Nov 26 00:44:48 UTC 2017 |