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_HAS_CXX11 0 |
Does the compiler support C++11? More... | |
#define | MRPT_OVERRIDE |
C++11 "override" for virtuals: More... | |
#define | MRPT_DEPRECATED_PRE(_MSG) |
#define | MRPT_DEPRECATED_POST(_MSG) |
#define | MRPT_DECLARE_DEPRECATED_FUNCTION(__MSG, __FUNC) MRPT_DEPRECATED_PRE(__MSG) __FUNC MRPT_DEPRECATED_POST(__MSG) |
Usage: MRPT_DECLARE_DEPRECATED_FUNCTION("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_NO_THROWS throw() |
Used after member declarations. More... | |
#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_CUSTOM_MSG1(msg, param1) |
#define | THROW_TYPED_EXCEPTION(msg, exceptionClass) |
Defines a unified way of reporting exceptions of type different from "std::exception". More... | |
#define | THROW_TYPED_EXCEPTION_CUSTOM_MSG1(msg, param1, 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_NO_THROWS throw() |
Used after member declarations. More... | |
#define | MRPT_FORCE_INLINE inline |
Tells the compiler we really want to inline that function. More... | |
#define | MRPT_MACROS_H |
#define | MRPT_HAS_CXX11 0 |
#define | MRPT_OVERRIDE |
#define | MRPT_DEPRECATED_PRE(_MSG) |
#define | MRPT_DEPRECATED_POST(_MSG) |
#define | MRPT_DECLARE_DEPRECATED_FUNCTION(__MSG, __FUNC) MRPT_DEPRECATED_PRE(__MSG) __FUNC MRPT_DEPRECATED_POST(__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_NO_THROWS throw() |
#define | MRPT_ALIGN16 |
#define | MRPT_ALIGN32 |
#define | __CURRENT_FUNCTION_NAME__ __PRETTY_FUNCTION__ |
#define | THROW_EXCEPTION(msg) |
#define | THROW_EXCEPTION_CUSTOM_MSG1(msg, param1) |
#define | THROW_TYPED_EXCEPTION(msg, exceptionClass) |
#define | THROW_TYPED_EXCEPTION_CUSTOM_MSG1(msg, param1, 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_NO_THROWS throw() |
#define | MRPT_FORCE_INLINE inline |
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 102 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::optimize_graph_spa_levmarq().
#define __CURRENT_FUNCTION_NAME__ __PRETTY_FUNCTION__ |
#define ASSERT_ | ( | f | ) | { } |
#define ASSERT_ | ( | f | ) | { } |
Definition at line 261 of file maps/CColouredPointsMap.h.
Referenced by mrpt::opengl::CMeshFast::adjustGridToImageAR(), mrpt::opengl::CMesh::adjustGridToImageAR(), 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(), 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::math::confidenceIntervals(), mrpt::math::CHistogram::createWithFixedWidth(), mrpt::math::crossProduct3D(), mrpt::random::CRandomGenerator::drawGaussianMultivariate(), mrpt::math::estimateJacobian(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::exactBisection(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::vision::find_descriptor_pairings(), mrpt::math::ModelSearch::geneticSingleModel(), mrpt::maps::CBeaconMap::get(), mrpt::poses::CPointPDFSOG::get(), mrpt::poses::CPosePDFSOG::get(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::utils::CMHPropertiesValuesList::getAs(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::poses::CPose2DGridTemplate< double >::getByIndex(), mrpt::utils::CMessage::getContentAsStruct(), mrpt::utils::CMHPropertiesValuesList::getElemental(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::getLandmarkMean(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getMostLikelyParticle(), mrpt::obs::CObservationGPS::getMsgByClass(), mrpt::nav::TMoveTree< TNodeSE2_TP, TMoveEdgeSE2_TP >::getNearestNode(), mrpt::hmtslam::CHMHMapArc::getNodeFrom(), mrpt::hmtslam::CHMHMapArc::getNodeTo(), mrpt::nav::CReactiveNavigationSystem3D::getPTG(), mrpt::nav::CReactiveNavigationSystem::getPTG(), mrpt::math::CBinaryRelation< T, U, UIsObject >::getRelationFrom(), mrpt::math::CBinaryRelation< T, U, UIsObject >::getRelationTo(), 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::math::detail::VicinityTraits< CMatrixFixedNumeric< T, D, D > >::initialize(), 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::math::minimum(), mrpt::math::minimum_maximum(), mrpt::math::ncc_vector(), 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< mrpt::maps::mrpt::maps::CMultiMetricMap >::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< mrpt::maps::mrpt::maps::CMultiMetricMap >::operator[](), mrpt::utils::copiable_NULL_ptr< T >::operator[](), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::performSubstitution(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::poses::CPose2DGridTemplate< double >::phi2idx(), mrpt::math::productIntegralAndMahalanobisTwoGaussians(), mrpt::math::productIntegralTwoGaussians(), mrpt::vision::pinhole::projectPoint_no_distortion(), mrpt::math::ModelSearch::ransacSingleModel(), mrpt::bayes::CRejectionSamplingCapable< mrpt::poses::CPose2D >::rejectionSampling(), mrpt::math::CBinaryRelation< T, U, UIsObject >::removeElementAt(), mrpt::opengl::COctoMapVoxels::reserveVoxels(), mrpt::opengl::COctoMapVoxels::resizeVoxels(), mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::runOneKalmanIteration(), mrpt::utils::CMemoryStream::setAllocBlockSize(), mrpt::maps::CPointsMap::setAllPointsTemplate(), mrpt::math::CSparseMatrix::setColCount(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::setCovMatrixAndMean(), mrpt::utils::TCamera::setDistortionParamsVector(), mrpt::opengl::CAxis::setFrequency(), 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::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::opengl::COctoMapVoxels::showVoxels(), mrpt::math::skew_symmetric3(), mrpt::math::skew_symmetric3_neg(), mrpt::math::detail::stub_kmeans(), mrpt::vision::TSIFTDescriptorsKDTreeIndex< distance_t, metric_t >::TSIFTDescriptorsKDTreeIndex(), mrpt::vision::TSURFDescriptorsKDTreeIndex< distance_t, metric_t >::TSURFDescriptorsKDTreeIndex(), mrpt::opengl::CSetOfTriangles::TTriangle::TTriangle(), mrpt::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), mrpt::poses::CPose2DGridTemplate< double >::x2idx(), and mrpt::poses::CPose2DGridTemplate< double >::y2idx().
#define ASSERT_ABOVE_ | ( | __A, | |
__B | |||
) | { } |
#define ASSERT_ABOVE_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 267 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphslam::optimize_graph_spa_levmarq().
#define ASSERT_ABOVEEQ_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 269 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 | |||
) | { } |
#define ASSERT_BELOW_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 266 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_BELOWEQ_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 268 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 272 of file maps/CColouredPointsMap.h.
#define ASSERT_DIRECTORY_EXISTS_ | ( | DIR | ) | { } |
#define ASSERT_EQUAL_ | ( | __A, | |
__B | |||
) | { } |
#define ASSERT_EQUAL_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 264 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::graphslam::optimize_graph_spa_levmarq(), mrpt::obs::detail::project3DPointsFromDepthImageInto(), mrpt::graphs::detail::graph_ops< graph_t >::read_graph_of_poses_from_binary_file(), mrpt::math::rodrigues_so3_exp(), mrpt::maps::CPointsMap::setAllPointsTemplate(), mrpt::kinematics::CKinematicChain::setConfiguration(), and mrpt::math::CSplineInterpolator1D::setXY().
#define ASSERT_FILE_EXISTS_ | ( | FIL | ) | { } |
Definition at line 271 of file maps/CColouredPointsMap.h.
Referenced by mrpt::pbmap::config_heuristics::load_params().
#define ASSERT_FILE_EXISTS_ | ( | FIL | ) | { } |
#define ASSERT_NOT_EQUAL_ | ( | __A, | |
__B | |||
) | { } |
#define ASSERT_NOT_EQUAL_ | ( | __A, | |
__B | |||
) | { } |
Definition at line 265 of file maps/CColouredPointsMap.h.
#define ASSERTDEB_ | ( | f | ) | { } |
Defines an assertion mechanism - only when compiled in debug.
Definition at line 283 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< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KF_aux_estimate_obs_Hx_jacobian(), mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::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< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::runOneKalmanIteration(), mrpt::maps::CSimplePointsMap::setPointAllFieldsFast(), mrpt::maps::CWeightedPointsMap::setPointAllFieldsFast(), mrpt::math::slerp(), mrpt::math::weightedHistogram(), and mrpt::math::weightedHistogramLog().
#define ASSERTDEB_ | ( | f | ) | { } |
#define ASSERTDEBMSG_ | ( | f, | |
__ERROR_MSG | |||
) | { } |
Definition at line 284 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 260 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::CDijkstra(), mrpt::poses::CPose3DQuat::iterator::check_limits(), mrpt::poses::CPose3DQuat::const_iterator::check_limits(), mrpt::math::covariancesAndMeanWeighted(), mrpt::math::CQuaternion< T >::CQuaternion(), mrpt::math::CSparseMatrix::CSparseMatrix(), mrpt::vision::find_descriptor_pairings(), mrpt::poses::CPose3DQuat::fromString(), mrpt::poses::CPose3DRotVec::fromString(), mrpt::poses::CPose3D::fromString(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::getEdgeSquareError(), mrpt::obs::CObservationGPS::getMsgByClass(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::getTreeGraph(), mrpt::graphs::detail::graph_ops< graph_t >::graph_edge_sqerror(), mrpt::math::meanAndCovMat(), mrpt::math::meanAndCovVec(), mrpt::math::ncc_vector(), mrpt::math::operator>>(), mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::runOneKalmanIteration(), and mrpt::math::detail::stub_kmeans().
#define M_2PI 6.283185307179586476925286766559 |
Definition at line 363 of file mrpt_macros.h.
Referenced by mrpt::nav::CParameterizedTrajectoryGenerator::alpha2index(), mrpt::math::covariancesAndMeanWeighted(), mrpt::utils::CEnhancedMetaFile::ellipseGaussian(), mrpt::utils::CCanvas::ellipseGaussian(), mrpt::math::mahalanobisDistance2AndLogPDF(), mrpt::math::normalPDF(), mrpt::math::normalPDFInf(), mrpt::math::productIntegralAndMahalanobisTwoGaussians(), and mrpt::math::productIntegralTwoGaussians().
#define M_2PIf 6.28318530717959f |
Definition at line 367 of file maps/CColouredPointsMap.h.
#define M_2PIf 6.28318530717959f |
#define M_PIf 3.14159265358979f |
Definition at line 366 of file maps/CColouredPointsMap.h.
Referenced by mrpt::utils::DEG2RAD(), and mrpt::utils::RAD2DEG().
#define M_PIf 3.14159265358979f |
#define MRPT_ALIGN16 |
#define MRPT_ALIGN16 |
Definition at line 92 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_ALIGN32 |
#define MRPT_ALIGN32 |
Definition at line 93 of file maps/CColouredPointsMap.h.
#define MRPT_CHECK_NORMAL_NUMBER | ( | val | ) | { } |
#define MRPT_CHECK_NORMAL_NUMBER | ( | val | ) | { } |
#define MRPT_COMPILE_TIME_ASSERT | ( | f | ) | { } |
#define MRPT_COMPILE_TIME_ASSERT | ( | f | ) | { } |
Definition at line 263 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_DECLARE_DEPRECATED_FUNCTION | ( | __MSG, | |
__FUNC | |||
) | MRPT_DEPRECATED_PRE(__MSG) __FUNC MRPT_DEPRECATED_POST(__MSG) |
#define MRPT_DECLARE_DEPRECATED_FUNCTION | ( | __MSG, | |
__FUNC | |||
) | MRPT_DEPRECATED_PRE(__MSG) __FUNC MRPT_DEPRECATED_POST(__MSG) |
Usage: MRPT_DECLARE_DEPRECATED_FUNCTION("Use XX instead", void myFunc(double));.
Definition at line 47 of file maps/CColouredPointsMap.h.
Referenced by mrpt::nav::CParameterizedTrajectoryGenerator::~CParameterizedTrajectoryGenerator().
#define MRPT_DEPRECATED_POST | ( | _MSG | ) |
Definition at line 43 of file maps/CColouredPointsMap.h.
#define MRPT_DEPRECATED_POST | ( | _MSG | ) |
#define MRPT_DEPRECATED_PRE | ( | _MSG | ) |
Definition at line 42 of file maps/CColouredPointsMap.h.
#define MRPT_DEPRECATED_PRE | ( | _MSG | ) |
#define MRPT_DO_PRAGMA | ( | x | ) |
Declare MRPT_TODO(message)
Definition at line 60 of file maps/CColouredPointsMap.h.
#define MRPT_DO_PRAGMA | ( | x | ) |
#define MRPT_END MRPT_TRY_END |
Definition at line 353 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::CDijkstra(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::clearParticles(), mrpt::math::confidenceIntervals(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::ESS(), mrpt::math::estimateJacobian(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::vision::find_descriptor_pairings(), mrpt::math::generateAxisBaseFromDirection(), mrpt::obs::CActionCollection::getActionByClass(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::utils::CMHPropertiesValuesList::getAs(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::opengl::CSetOfObjects::getByClass(), mrpt::opengl::COpenGLScene::getByClass(), mrpt::opengl::COpenGLViewport::getByClass(), mrpt::utils::CMessage::getContentAsStruct(), mrpt::utils::CMHPropertiesValuesList::getElemental(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getMostLikelyParticle(), mrpt::obs::CSensoryFrame::getObservationByClass(), mrpt::utils::CClientTCPSocket::getPosition(), mrpt::hwdrivers::CSerialPort::getPosition(), 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::maps::COctoMapBase< OCTREE, OCTREE_NODE >::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::opengl::CPointCloud::loadFromPointsList(), mrpt::math::mahalanobisDistance2(), mrpt::math::mahalanobisDistance2AndLogPDF(), 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::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::performSubstitution(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_implementation_pfStandardProposal(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::utils::CConfigFileBase::read_enum(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::readParticlesFromStream(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::bayes::CRejectionSamplingCapable< mrpt::poses::CPose2D >::rejectionSampling(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::render_dl(), mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::runOneKalmanIteration(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::saveMetricMapRepresentationToFile(), mrpt::utils::CClientTCPSocket::Seek(), mrpt::hwdrivers::CSerialPort::Seek(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::setCovMatrixAndMean(), mrpt::utils::CImage::setFromMatrix(), mrpt::utils::CImage::setFromRGBMatrices(), mrpt::math::CSplineInterpolator1D::setXY(), mrpt::gui::CDisplayWindow::showImageAndPoints(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::gui::CDisplayWindow::showTiledImageAndPoints(), mrpt::math::detail::stub_kmeans(), mrpt::math::transform_gaussian_linear(), mrpt::math::transform_gaussian_montecarlo(), mrpt::math::transform_gaussian_unscented(), mrpt::opengl::COpenGLScene::visitAllObjects(), mrpt::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), and mrpt::bayes::CParticleFilterData< CRBPFParticleData >::writeParticlesToStream().
#define MRPT_END MRPT_TRY_END |
#define MRPT_END_WITH_CLEAN_UP | ( | stuff | ) | MRPT_TRY_END_WITH_CLEAN_UP(stuff) |
Definition at line 356 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 397 of file maps/CColouredPointsMap.h.
#define MRPT_FORCE_INLINE inline |
#define MRPT_HAS_CXX11 0 |
Does the compiler support C++11?
Definition at line 21 of file maps/CColouredPointsMap.h.
#define MRPT_HAS_CXX11 0 |
#define MRPT_MACROS_H |
Definition at line 12 of file maps/CColouredPointsMap.h.
#define MRPT_MSG_PRAGMA | ( | _msg | ) |
Definition at line 61 of file maps/CColouredPointsMap.h.
#define MRPT_MSG_PRAGMA | ( | _msg | ) |
#define MRPT_NO_THROWS throw() |
#define MRPT_NO_THROWS throw() |
Used after member declarations.
Definition at line 391 of file maps/CColouredPointsMap.h.
Referenced by mrpt::system::createThreadFromObjectMethod(), mrpt::utils::CImage::forceLoad(), mrpt::utils::CImage::getSize(), and mrpt::math::size().
#define MRPT_NO_THROWS throw() |
#define MRPT_NO_THROWS throw() |
Used after member declarations.
Definition at line 391 of file maps/CColouredPointsMap.h.
#define MRPT_OVERRIDE |
C++11 "override" for virtuals:
Definition at line 28 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::maps::TSetOfMetricMapInitializers::clear(), mrpt::opengl::CRenderizableDisplayList::clone(), mrpt::poses::CPose3DPDFParticles::CPose3DPDFParticles(), mrpt::poses::CPosePDFParticles::CPosePDFParticles(), mrpt::opengl::CSetOfObjects::empty(), mrpt::poses::CPointPDFSOG::empty(), mrpt::maps::CPointsMap::empty(), mrpt::gui::CDisplayWindow::enableCursorCoordinatesVisualization(), mrpt::opengl::C3DSScene::enableExtraAmbientLight(), mrpt::opengl::CAxis::enableTickMarks(), 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< TMoveEdgeSE2_TP >::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::CGridPlaneXY::getGridFrequency(), mrpt::opengl::CGridPlaneXZ::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::obs::CObservationRFID::getNtags(), mrpt::opengl::CTexturedPlane::getPlaneCorners(), mrpt::poses::CPose3DQuatPDFGaussian::getPoseMean(), mrpt::poses::CPose2D::getPoseMean(), mrpt::poses::CPose3DRotVec::getPoseMean(), 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::maps::CPointsMap::mark_as_modified(), 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::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::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::CObservationVisualLandmarks::setSensorPose(), mrpt::obs::CObservationOdometry::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::CObservation2DRangeScan::setSensorPose(), mrpt::obs::CObservationGPS::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_OVERRIDE |
#define MRPT_printf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
Definition at line 379 of file maps/CColouredPointsMap.h.
Referenced by mrpt::utils::CStream::WriteBufferFixEndianness().
#define MRPT_printf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
#define MRPT_printf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
#define MRPT_printf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
Definition at line 379 of file maps/CColouredPointsMap.h.
#define MRPT_PROFILE_FUNC_START |
Definition at line 342 of file maps/CColouredPointsMap.h.
#define MRPT_PROFILE_FUNC_START |
#define MRPT_scanf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
#define MRPT_scanf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
Definition at line 386 of file maps/CColouredPointsMap.h.
#define MRPT_scanf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
#define MRPT_scanf_format_check | ( | _FMT_, | |
_VARARGS_ | |||
) |
Definition at line 386 of file maps/CColouredPointsMap.h.
#define MRPT_START |
Definition at line 349 of file maps/CColouredPointsMap.h.
Referenced by mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::CDijkstra(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::clearParticles(), mrpt::math::confidenceIntervals(), mrpt::utils::CEnhancedMetaFile::ellipseGaussian(), mrpt::utils::CCanvas::ellipseGaussian(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::ESS(), mrpt::math::estimateJacobian(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::vision::find_descriptor_pairings(), mrpt::math::generateAxisBaseFromDirection(), mrpt::obs::CActionCollection::getActionByClass(), mrpt::maps::CPointsMap::getAllPoints(), mrpt::utils::CMHPropertiesValuesList::getAs(), mrpt::poses::CPose2DGridTemplate< double >::getAsMatrix(), mrpt::opengl::CSetOfObjects::getByClass(), mrpt::opengl::COpenGLScene::getByClass(), mrpt::opengl::COpenGLViewport::getByClass(), mrpt::utils::CMessage::getContentAsStruct(), mrpt::utils::CMHPropertiesValuesList::getElemental(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::getMostLikelyParticle(), mrpt::obs::CSensoryFrame::getObservationByClass(), mrpt::utils::CClientTCPSocket::getPosition(), mrpt::hwdrivers::CSerialPort::getPosition(), 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::maps::COctoMapBase< OCTREE, OCTREE_NODE >::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::opengl::CPointCloud::loadFromPointsList(), mrpt::math::mahalanobisDistance2(), mrpt::math::mahalanobisDistance2AndLogPDF(), 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::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >::performSubstitution(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_implementation_pfStandardProposal(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_particlesEvaluator_AuxPFOptimal(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_particlesEvaluator_AuxPFStandard(), mrpt::utils::CConfigFileBase::read_enum(), mrpt::bayes::CParticleFilterData< CRBPFParticleData >::readParticlesFromStream(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::bayes::CRejectionSamplingCapable< mrpt::poses::CPose2D >::rejectionSampling(), mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::render_dl(), mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::runOneKalmanIteration(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::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::math::CSplineInterpolator1D::setXY(), mrpt::gui::CDisplayWindow::showImageAndPoints(), mrpt::gui::CDisplayWindow::showImagesAndMatchedPoints(), mrpt::gui::CDisplayWindow::showTiledImageAndPoints(), mrpt::math::detail::stub_kmeans(), mrpt::math::transform_gaussian_linear(), mrpt::math::transform_gaussian_montecarlo(), mrpt::math::transform_gaussian_unscented(), mrpt::opengl::COpenGLScene::visitAllObjects(), mrpt::math::weightedHistogram(), mrpt::math::weightedHistogramLog(), and mrpt::bayes::CParticleFilterData< CRBPFParticleData >::writeParticlesToStream().
#define MRPT_START |
#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 200 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) |
Definition at line 65 of file maps/CColouredPointsMap.h.
Referenced by mrpt::nav::TMoveTree< TNodeSE2_TP, TMoveEdgeSE2_TP >::getNearestNode().
#define MRPT_TODO | ( | x | ) | MRPT_MSG_PRAGMA("TODO: " x) |
#define MRPT_TRY_END |
Definition at line 335 of file maps/CColouredPointsMap.h.
Referenced by mrpt::opengl::graph_tools::graph_visualize().
#define MRPT_TRY_END |
#define MRPT_TRY_END_WITH_CLEAN_UP | ( | stuff | ) |
#define MRPT_TRY_END_WITH_CLEAN_UP | ( | stuff | ) |
Definition at line 336 of file maps/CColouredPointsMap.h.
#define MRPT_TRY_START |
#define MRPT_TRY_START |
Definition at line 334 of file maps/CColouredPointsMap.h.
Referenced by mrpt::opengl::graph_tools::graph_visualize().
#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 290 of file maps/CColouredPointsMap.h.
Referenced by mrpt::maps::CSimplePointsMap::addFrom_classSpecific(), mrpt::math::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::nav::CAbstractPTGBasedReactive::enableTimeLog(), 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::nav::CReactiveInterfaceImplementation::notifyHeadingDirection(), 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::math::CArray< T, 0 >::operator=(), mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >::PF_SLAM_implementation_doWeHaveValidObservations(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::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::nav::CReactiveInterfaceImplementation::startWatchdog(), mrpt::hwdrivers::CPtuDPerception::status(), mrpt::math::detail::stub_kmeans(), mrpt::math::CArray< T, 0 >::swap(), and mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::traceRay().
#define MRPT_WARNING | ( | x | ) | MRPT_MSG_PRAGMA("Warning: " x) |
Definition at line 64 of file maps/CColouredPointsMap.h.
#define MRPT_WARNING | ( | x | ) | MRPT_MSG_PRAGMA("Warning: " x) |
#define THROW_EXCEPTION | ( | msg | ) |
#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 110 of file maps/CColouredPointsMap.h.
Referenced by mrpt::poses::CPose3DQuat::iterator::check_limits(), mrpt::poses::CPose3DQuat::const_iterator::check_limits(), mrpt::hmtslam::CHMTSLAM::CHMTSLAM(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::CMatrixTemplate(), mrpt::utils::bimap< mrpt::maps::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::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::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::math::CSparseMatrix::insert_submatrix(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::insertCol(), mrpt::utils::bimap< mrpt::maps::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::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< mrpt::maps::mrpt::maps::CMultiMetricMap >::operator=(), mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >::operator=(), mrpt::hmtslam::CHMTSLAM::operator=(), mrpt::math::TObject3D::operator=(), mrpt::utils::operator>>(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_implementation_gatherActionsCheckBothActObs(), mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF >::PF_SLAM_implementation_pfStandardProposal(), mrpt::utils::CStdOutStream::Read(), mrpt::utils::CConfigFileBase::read_enum(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::math::round2up(), mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::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::hwdrivers::CSerialPort::setSerialPortName(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::SpectralBisection(), and mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >::traceRay().
#define THROW_EXCEPTION_CUSTOM_MSG1 | ( | msg, | |
param1 | |||
) |
#define THROW_EXCEPTION_CUSTOM_MSG1 | ( | msg, | |
param1 | |||
) |
e | The caught exception. |
msg | Is a char* or literal string. |
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_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_STACKED_EXCEPTION | ( | e | ) |
#define THROW_STACKED_EXCEPTION | ( | e | ) |
Definition at line 163 of file maps/CColouredPointsMap.h.
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG1 | ( | e, | |
msg | |||
) |
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG1 | ( | e, | |
msg | |||
) |
Definition at line 179 of file maps/CColouredPointsMap.h.
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG2 | ( | e, | |
stuff, | |||
param1 | |||
) |
#define THROW_STACKED_EXCEPTION_CUSTOM_MSG2 | ( | e, | |
stuff, | |||
param1 | |||
) |
Definition at line 191 of file maps/CColouredPointsMap.h.
#define THROW_TYPED_EXCEPTION | ( | msg, | |
exceptionClass | |||
) |
#define THROW_TYPED_EXCEPTION | ( | msg, | |
exceptionClass | |||
) |
Defines a unified way of reporting exceptions of type different from "std::exception".
Definition at line 137 of file maps/CColouredPointsMap.h.
#define THROW_TYPED_EXCEPTION_CUSTOM_MSG1 | ( | msg, | |
param1, | |||
exceptionClass | |||
) |
Definition at line 150 of file maps/CColouredPointsMap.h.
#define THROW_TYPED_EXCEPTION_CUSTOM_MSG1 | ( | msg, | |
param1, | |||
exceptionClass | |||
) |
Page generated by Doxygen 1.8.11 for MRPT 1.4.0 SVN: at Sun Aug 14 23:58:29 UTC 2016 |