MRPT  2.0.0
Namespaces | Classes | Typedefs | Functions | Variables
mrpt Namespace Reference

Detailed Description

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

Namespaces

 apps
 
 bayes
 The namespace for Bayesian filtering algorithm: different particle filters and Kalman filter algorithms.
 
 comms
 Serial and networking devices and utilities.
 
 config
 
 containers
 
 cpu
 
 detectors
 
 expr
 
 global_settings
 Global variables to change the run-time behaviour of some MRPT classes within mrpt-base.
 
 graphs
 Abstract graph and tree data structures, plus generic graph algorithms.
 
 graphslam
 SLAM methods related to graphs of pose constraints.
 
 gui
 Classes for creating GUI windows for 2D and 3D visualization.
 
 hmtslam
 Classes related to the implementation of Hybrid Metric Topological (HMT) SLAM.
 
 hwdrivers
 Contains classes for various device interfaces.
 
 img
 
 internal
 
 io
 
 kinematics
 
 maps
 
 math
 This base provides a set of functions for maths stuff.
 
 mrpt
 
 nav
 
 obs
 This namespace contains representation of robot actions and observations.
 
 opengl
 The namespace for 3D scene representation and rendering.
 
 poses
 Classes for 2D/3D geometry representation, both of single values and probability density distributions (PDFs) in many forms.
 
 random
 A namespace of pseudo-random numbers generators of diferent distributions.
 
 ros1bridge
 ROS message: http://docs.ros.org/api/sensor_msgs/html/msg/NavSatFix.html MRPT message: https://github.com/MRPT/mrpt/blob/master/libs/obs/include/mrpt/obs/CObservationGPS.h.
 
 rtti
 
 serialization
 
 slam
 
 system
 
 tfest
 Functions for estimating the optimal transformation between two frames of references given measurements of corresponding points.
 
 topography
 This namespace provides topography helper functions, coordinate transformations.
 
 typemeta
 
 utils
 
 vision
 Classes for computer vision, detectors, features, etc.
 

Classes

class  aligned_allocator_cpp11
 Aligned allocator that is compatible with C++11. More...
 
class  Clock
 Clock that is compatible with MRPT TTimeStamp representation. More...
 
struct  copiable_NULL_ptr
 A wrapper class for pointers that, if copied with the "=" operator, should be set to nullptr in the new copy. More...
 
struct  copiable_NULL_ptr_basic
 A wrapper class for pointers that, if copied with the "=" operator, should be set to nullptr in the copy. More...
 
struct  enable_if_t<(sizeof(T) > 0)> >
 
struct  ignored_copy_ptr
 A wrapper class for pointers whose copy operations from other objects of the same type are ignored, that is, doing "a=b;" has no effect neiter on "a" or "b". More...
 
struct  int_select_by_bytecount
 Usage: int_select_by_bytecount<N>::type var; allows defining var as a signed integer with, at least, N bytes. More...
 
struct  int_select_by_bytecount< 1 >
 
struct  int_select_by_bytecount< 2 >
 
struct  int_select_by_bytecount< 3 >
 
struct  int_select_by_bytecount< 4 >
 
struct  int_select_by_bytecount< 8 >
 
struct  is_defined
 Checks if type is defined (fails for forward declarations). More...
 
struct  is_shared_ptr
 This is useful for checking ::Ptr types. More...
 
struct  is_shared_ptr< std::shared_ptr< T > >
 
class  LockHelper
 Auxiliary helper structure for mrpt::lockHelper() More...
 
struct  non_copiable_ptr
 A wrapper class for pointers that can NOT be copied with "=" operator, raising an exception at runtime if a copy is attempted. More...
 
struct  non_copiable_ptr_basic
 A wrapper class for pointers that can NOT be copied with "=" operator, raising an exception at runtime if a copy is attempted. More...
 
struct  ptr_cast
 Converts a polymorphic smart pointer Base::Ptr to Derived::Ptr, in a way compatible with MRPT >=1.5.4 and MRPT 2.x series. More...
 
struct  safe_ptr
 A wrapper class for pointers that can be safely copied with "=" operator without problems. More...
 
struct  safe_ptr_basic
 A wrapper class for pointers that can be safely copied with "=" operator without problems. More...
 
struct  uint_select_by_bytecount
 Usage: uint_select_by_bytecount<N>::type var; allows defining var as a unsigned integer with, at least, N bytes. More...
 
struct  uint_select_by_bytecount< 1 >
 
struct  uint_select_by_bytecount< 2 >
 
struct  uint_select_by_bytecount< 3 >
 
struct  uint_select_by_bytecount< 4 >
 
struct  uint_select_by_bytecount< 8 >
 

Typedefs

template<class T >
using aligned_std_basicstring = std::basic_string< T, std::char_traits< T >, mrpt::aligned_allocator_cpp11< T > >
 
template<class T >
using aligned_std_vector = std::vector< T, mrpt::aligned_allocator_cpp11< T > >
 
template<class T >
using optional_ref = std::optional< std::reference_wrapper< T > >
 Shorter name for std::optional<std::reference_wrapper<T>> More...
 
template<typename T >
using pimpl = spimpl::impl_ptr< T >
 
using void_ptr = safe_ptr_basic< void >
 
using void_ptr_noncopy = non_copiable_ptr_basic< void >
 

Functions

template<class Visitor , class... T>
void visit_each (const Visitor &vis, T &&... t)
 
void * aligned_malloc (size_t size, size_t alignment)
 
void * aligned_realloc (void *ptr, size_t size, size_t alignment)
 
void aligned_free (void *ptr)
 
void * aligned_calloc (size_t bytes, size_t alignment)
 Identical to aligned_malloc, but it zeroes the reserved memory block. More...
 
template<typename num_t , typename return_t = num_t>
return_t square (const num_t x)
 Inline function for the square of a number. More...
 
template<class T >
hypot_fast (const T x, const T y)
 Faster version of std::hypot(), to use when overflow is not an issue and we prefer fast code. More...
 
constexpr double DEG2RAD (const double x)
 Degrees to radians. More...
 
constexpr float DEG2RAD (const float x)
 Degrees to radians. More...
 
constexpr double DEG2RAD (const int x)
 Degrees to radians. More...
 
constexpr double RAD2DEG (const double x)
 Radians to degrees. More...
 
constexpr float RAD2DEG (const float x)
 Radians to degrees. More...
 
constexpr long double DEG2RAD (const long double x)
 Degrees to radians. More...
 
constexpr long double RAD2DEG (const long double x)
 Radians to degrees. More...
 
constexpr double operator"" _deg (long double v)
 degrees to radian literal operator (e.g. More...
 
template<typename T >
int sign (T x)
 Returns the sign of X as "1" or "-1". More...
 
template<typename T >
int signWithZero (T x)
 Returns the sign of X as "0", "1" or "-1". More...
 
template<typename T >
lowestPositive (const T a, const T b)
 Returns the smallest positive number among a and b. More...
 
template<typename T >
abs_diff (const T a, const T b)
 Efficient and portable evaluation of the absolute difference of two unsigned integer values (but will also work for signed and floating point types) More...
 
template<typename T >
const T min3 (const T &A, const T &B, const T &C)
 
template<typename T >
const T max3 (const T &A, const T &B, const T &C)
 
template<typename T >
int fix (T x)
 Rounds toward zero. More...
 
template<typename T , typename K >
void keep_min (T &var, const K test_val)
 If the second argument is below the first one, set the first argument to this lower value. More...
 
template<typename T , typename K >
void keep_max (T &var, const K test_val)
 If the second argument is above the first one, set the first argument to this higher value. More...
 
template<typename T >
void saturate (T &var, const T sat_min, const T sat_max)
 Saturate the value of var (the variable gets modified) so it does not get out of [min,max]. More...
 
template<typename T >
saturate_val (const T &value, const T sat_min, const T sat_max)
 Like saturate() but it returns the value instead of modifying the variable. More...
 
template<class T >
round2up (T val)
 Round up to the nearest power of two of a given number. More...
 
float d2f (const double d)
 shortcut for static_cast<float>(double) More...
 
uint8_t f2u8 (const float f)
 converts a float [0,1] into an uint8_t [0,255] (without checking for out of bounds) More...
 
float u8tof (const uint8_t v)
 converts a uint8_t [0,255] into a float [0,1] More...
 
template<class VECTOR_T >
void vector_strong_clear (VECTOR_T &v)
 Like calling a std::vector<>'s clear() method, but really forcing deallocating the memory. More...
 
std::string exception_to_str (const std::exception &e)
 Builds a nice textual representation of a nested exception, which if generated using MRPT macros (THROW_EXCEPTION,...) in between MRPT_START/MRPT_END macros, will contain function names and line numbers across the call stack at the original throw point. More...
 
std::string format_impl (const char *fmt,...) MRPT_printf_format_check(1
 A std::string version of C sprintf. More...
 
template<typename... ARGS>
std::string std::string format (std::string_view fmt, ARGS &&... args)
 
template<typename T >
std::string to_string (T v)
 Just like std::to_string(), but with an overloaded version for std::string arguments. More...
 
template<>
std::string to_string (std::string v)
 
template<>
std::string to_string (bool v)
 
template<>
std::string to_string (const char *s)
 
template<typename T >
from_string (const std::string &s, const T &defValue=T{}, bool throw_on_error=true)
 Converts from string to any data type that supports reading (>>) from a text stream. More...
 
template<class T >
get_env (const std::string &varname, const T &defValue=T())
 Reads an environment variable, with a default value if not present. More...
 
template<class T >
LockHelper< T > lockHelper (T &t)
 Syntactic sugar to easily create a locker to any kind of std::mutex. More...
 
template<class T , class... Args>
pimpl< T > make_impl (Args &&... args)
 
void reverseBytesInPlace (bool &v_in_out)
 Reverse the order of the bytes of a given type (useful for transforming btw little/big endian) More...
 
void reverseBytesInPlace (uint8_t &v_in_out)
 
void reverseBytesInPlace (int8_t &v_in_out)
 
void reverseBytesInPlace (uint16_t &v_in_out)
 
void reverseBytesInPlace (int16_t &v_in_out)
 
void reverseBytesInPlace (uint32_t &v_in_out)
 
void reverseBytesInPlace (int32_t &v_in_out)
 
void reverseBytesInPlace (uint64_t &v_in_out)
 
void reverseBytesInPlace (int64_t &v_in_out)
 
void reverseBytesInPlace (float &v_in_out)
 
void reverseBytesInPlace (double &v_in_out)
 
void reverseBytesInPlace (long double &v_in_out)
 
void reverseBytesInPlace (std::chrono::time_point< mrpt::Clock > &v_in_out)
 
template<class T >
void reverseBytes (const T &v_in, T &v_out)
 Reverse the order of the bytes of a given type (useful for transforming btw little/big endian) More...
 
template<class T >
reverseBytes (const T &v_in)
 
template<class T >
toNativeEndianness (const T &v_in)
 
template<typename enum_t , typename underlying_t = typename std::underlying_type<enum_t>::type>
void reverseBytesInPlace_enum (enum_t &v)
 
template<typename T >
int round (const T value)
 Returns the closer integer (int) to x. More...
 
template<typename T >
long round_long (const T value)
 Returns the closer integer (long) to x. More...
 
template<class T >
round_10power (T val, int power10)
 Round a decimal number up to the given 10'th power (eg, to 1000,100,10, and also fractions) power10 means round up to: 1 -> 10, 2 -> 100, 3 -> 1000, ... More...
 

Variables

template<class T >
constexpr bool is_defined_v = is_defined<T>::value
 

Typedef Documentation

◆ aligned_std_basicstring

template<class T >
using mrpt::aligned_std_basicstring = typedef std::basic_string<T, std::char_traits<T>, mrpt::aligned_allocator_cpp11<T> >

Definition at line 16 of file aligned_std_basicstring.h.

◆ aligned_std_vector

template<class T >
using mrpt::aligned_std_vector = typedef std::vector<T, mrpt::aligned_allocator_cpp11<T> >

Definition at line 15 of file aligned_std_vector.h.

◆ pimpl

template<typename T >
using mrpt::pimpl = typedef spimpl::impl_ptr<T>

Definition at line 15 of file pimpl.h.

◆ void_ptr

using mrpt::void_ptr = typedef safe_ptr_basic<void>

Definition at line 362 of file safe_pointers.h.

◆ void_ptr_noncopy

Definition at line 363 of file safe_pointers.h.

Function Documentation

◆ aligned_calloc()

void * mrpt::aligned_calloc ( size_t  bytes,
size_t  alignment 
)
inline

Identical to aligned_malloc, but it zeroes the reserved memory block.

Definition at line 16 of file aligned_malloc.cpp.

References aligned_malloc().

Here is the call graph for this function:

◆ aligned_free()

void mrpt::aligned_free ( void *  ptr)

Definition at line 40 of file aligned_malloc.cpp.

Referenced by mrpt::aligned_allocator_cpp11< T, AligmentBytes >::deallocate().

Here is the caller graph for this function:

◆ aligned_malloc()

void * mrpt::aligned_malloc ( size_t  size,
size_t  alignment 
)

Definition at line 22 of file aligned_malloc.cpp.

References mrpt::math::size().

Referenced by aligned_calloc(), and mrpt::aligned_allocator_cpp11< T, AligmentBytes >::allocate().

Here is the call graph for this function:
Here is the caller graph for this function:

◆ aligned_realloc()

void * mrpt::aligned_realloc ( void *  ptr,
size_t  size,
size_t  alignment 
)

Definition at line 48 of file aligned_malloc.cpp.

References mrpt::math::size().

Here is the call graph for this function:

◆ format()

template<typename... ARGS>
std::string std::string mrpt::format ( std::string_view  fmt,
ARGS &&...  args 
)

Definition at line 26 of file format.h.

References format_impl().

Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::_execGraphSlamStep(), mrpt::rtti::CClassRegistry::Add(), mrpt::graphslam::detail::CEdgeCounter::addEdge(), mrpt::graphslam::detail::CEdgeCounter::addEdgeType(), mrpt::slam::CGridMapAligner::AlignPDF_robustMatch(), mrpt::graphslam::TUncertaintyPath< GRAPH_T >::assertIsBetweenNodeIDs(), mrpt::system::TCallStackBackTrace::asString(), mrpt::kinematics::CVehicleVelCmd::asString(), mrpt::poses::CPoint< CPoint3D, 3 >::asString(), mrpt::math::TTwist2D::asString(), mrpt::math::TPose3DQuat::asString(), mrpt::math::TPose2D::asString(), mrpt::math::TTwist3D::asString(), mrpt::math::TPose3D::asString(), mrpt::math::TPoint2D_< double >::asString(), mrpt::math::TPoint3D_< float >::asString(), mrpt::poses::CPose3DQuat::asString(), mrpt::poses::CPose2D::asString(), mrpt::poses::CPose3D::asString(), mrpt::maps::CGasConcentrationGridMap2D::build_Gaussian_Wind_Grid(), mrpt::nav::CAbstractPTGBasedReactive::build_movement_candidate(), mrpt::nav::CAbstractPTGBasedReactive::calc_move_candidate_scores(), mrpt::hwdrivers::CRovio::captureImageAsync(), mrpt::io::CFileGZOutputStream::CFileGZOutputStream(), mrpt::vision::checkerBoardStereoCalibration(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::checkRegistrationDeciderExists(), mrpt::hwdrivers::CImageGrabber_dc1394::CImageGrabber_dc1394(), mrpt::hwdrivers::CImageGrabber_OpenCV::CImageGrabber_OpenCV(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::CMatrixDynamic(), mrpt::io::zip::compress_gz_data_block(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::computeDominantEigenVector(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::computeMap(), mrpt::bayes::CParticleFilterCapable::computeResampling(), mrpt::hmtslam::CTopLCDetector_GridMatching::computeTopologicalObservationModel(), mrpt::comms::CClientTCPSocket::connect(), mrpt::hwdrivers::COpenNI2Generic::COpenNI2Generic(), mrpt::math::CQuaternion< T >::CQuaternion(), mrpt::system::createDirectory(), mrpt::system::dateTimeLocalToString(), mrpt::system::dateTimeToString(), mrpt::system::dateToString(), mrpt::nav::CParameterizedTrajectoryGenerator::debugDumpInFiles(), mrpt::nav::CMultiObjectiveMotionOptimizerBase::decide(), mrpt::rtti::TRuntimeClassId::derivedFrom(), mrpt::config::simpleini::MRPT_IniFileParser::do_parse(), mrpt::apps::MonteCarloLocalization_Base::do_pf_localization(), mrpt::hwdrivers::CNTRIPEmitter::doProcess(), mrpt::hwdrivers::CGPSInterface::doProcess(), mrpt::img::CImage::drawChessboardCorners(), mrpt::img::CCanvas::drawFeatures(), mrpt::graphs::detail::CVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >::drawNodeCorners(), mrpt::hmtslam::CLocalMetricHypothesis::dumpAsText(), mrpt::hmtslam::CHierarchicalMapMHPartition::dumpAsText(), mrpt::opengl::Program::dumpProgramDescription(), mrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >::dumpRegistrarsToConsole(), mrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromAA::dumpToConsole(), mrpt::tfest::TMatchingPairList::dumpToFile(), mrpt::obs::gnss::Message_NMEA_GGA::dumpToStream(), mrpt::obs::gnss::Message_TOPCON_PZS::dumpToStream(), mrpt::obs::gnss::Message_TOPCON_SATS::dumpToStream(), mrpt::obs::gnss::Message_NMEA_GLL::dumpToStream(), mrpt::obs::gnss::Message_NMEA_RMC::dumpToStream(), mrpt::obs::gnss::Message_NMEA_VTG::dumpToStream(), mrpt::obs::gnss::Message_NV_OEM6_GENERIC_FRAME::dumpToStream(), mrpt::obs::gnss::Message_NMEA_GSA::dumpToStream(), mrpt::obs::gnss::Message_NV_OEM6_GENERIC_SHORT_FRAME::dumpToStream(), mrpt::obs::gnss::Message_NMEA_ZDA::dumpToStream(), mrpt::obs::gnss::Message_NV_OEM6_RANGECMP::dumpToStream(), mrpt::obs::gnss::Message_NV_OEM6_VERSION::dumpToStream(), mrpt::slam::TKLDParams::dumpToTextStream(), mrpt::slam::CMetricMapBuilderICP::TConfigParams::dumpToTextStream(), mrpt::maps::CGasConcentrationGridMap2D::TInsertionOptions::dumpToTextStream(), mrpt::graphslam::TUncertaintyPath< GRAPH_T >::dumpToTextStream(), mrpt::graphslam::TSlidingWindow::dumpToTextStream(), mrpt::bayes::TKF_options::dumpToTextStream(), mrpt::slam::CMetricMapBuilderRBPF::TConstructionOptions::dumpToTextStream(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::TParams::dumpToTextStream(), mrpt::maps::CHeightGridMap2D::TInsertionOptions::dumpToTextStream(), mrpt::maps::CBeaconMap::TLikelihoodOptions::dumpToTextStream(), mrpt::slam::CRangeBearingKFSLAM2D::TOptions::dumpToTextStream(), mrpt::maps::CMultiMetricMapPDF::TPredictionParams::dumpToTextStream(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::maps::CRandomFieldGridMap3D::TInsertionOptions::dumpToTextStream(), mrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >::TParams::dumpToTextStream(), mrpt::maps::CBeaconMap::TInsertionOptions::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::TParams::dumpToTextStream(), mrpt::slam::CRangeBearingKFSLAM::TOptions::dumpToTextStream(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::GraphVisualizationParams::dumpToTextStream(), mrpt::maps::CLandmarksMap::TInsertionOptions::dumpToTextStream(), mrpt::vision::TStereoSystemParams::dumpToTextStream(), mrpt::vision::CFeature::dumpToTextStream(), mrpt::maps::TSetOfMetricMapInitializers::dumpToTextStream(), mrpt::maps::CLandmarksMap::TLikelihoodOptions::dumpToTextStream(), mrpt::vision::TMatchingOptions::dumpToTextStream(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TLoopClosureParams::dumpToTextStream(), mrpt::maps::COccupancyGridMap2D::TLikelihoodOptions::dumpToTextStream(), mrpt::vision::TMultiResDescMatchOptions::dumpToTextStream(), mrpt::vision::TMultiResDescOptions::dumpToTextStream(), mrpt::maps::CWirelessPowerGridMap2D::TMapDefinition::dumpToTextStream_map_specific(), mrpt::maps::CHeightGridMap2D_MRF::TMapDefinition::dumpToTextStream_map_specific(), mrpt::maps::CHeightGridMap2D::TMapDefinition::dumpToTextStream_map_specific(), mrpt::maps::CGasConcentrationGridMap2D::TMapDefinition::dumpToTextStream_map_specific(), mrpt::maps::CLandmarksMap::TMapDefinition::dumpToTextStream_map_specific(), mrpt::config::CLoadableOptions::dumpVar_bool(), mrpt::config::CLoadableOptions::dumpVar_double(), mrpt::config::CLoadableOptions::dumpVar_float(), mrpt::config::CLoadableOptions::dumpVar_int(), mrpt::config::CLoadableOptions::dumpVar_string(), mrpt::nav::CAbstractPTGBasedReactive::enableLogFile(), mrpt::hwdrivers::CImageGrabber_dc1394::enumerateCameras(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::evalPWConsistenciesMatrix(), mrpt::math::RANSAC_Template< NUMTYPE >::execute(), mrpt::bayes::CParticleFilter::executeOn(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::extractSubGraph(), mrpt::cpu::features_as_string(), mrpt::hmtslam::CHierarchicalMapMHPartition::findPathBetweenNodes(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::findPathByEnds(), for(), mrpt::system::formatTimeInterval(), mrpt::math::CQuaternion< T >::fromRodriguesVector(), mrpt::rtti::CListOfClasses::fromString(), mrpt::hwdrivers::CRovio::general_command(), mrpt::hwdrivers::CSICKTim561Eth::generateCmd(), mrpt::hwdrivers::CLMS100Eth::generateCmd(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::generateHypotsPool(), mrpt::hmtslam::CHMTSLAM::generateLogFiles(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::generateReportFiles(), mrpt::hmtslam::CHMTSLAM::generateUniqueAreaLabel(), generic_dump_BESTPOS(), generic_dump_MARKTIME(), generic_getFieldValues_MARKTIME(), get_ascii_item(), get_binary_item(), get_item_value(), get_stored_item(), mrpt::obs::gnss::Message_NMEA_GGA::getAllFieldValues(), mrpt::obs::gnss::Message_NMEA_GLL::getAllFieldValues(), mrpt::obs::gnss::Message_NMEA_RMC::getAllFieldValues(), mrpt::obs::gnss::Message_NMEA_VTG::getAllFieldValues(), mrpt::obs::gnss::Message_NMEA_GSA::getAllFieldValues(), mrpt::obs::gnss::Message_NMEA_ZDA::getAllFieldValues(), mrpt::slam::CRangeBearingKFSLAM2D::getAs3DObject(), mrpt::maps::CBeacon::getAs3DObject(), mrpt::slam::CRangeBearingKFSLAM::getAs3DObject(), mrpt::kinematics::CKinematicChain::getAs3DObject(), mrpt::maps::CLandmarksMap::getAs3DObject(), mrpt::hmtslam::CLocalMetricHypothesis::getAs3DScene(), mrpt::slam::CIncrementalMapPartitioner::getAs3DScene(), mrpt::hmtslam::CHierarchicalMapMHPartition::getAs3DScene(), mrpt::nav::TWaypointSequence::getAsOpenglVisualization(), mrpt::nav::TWaypointStatusSequence::getAsOpenglVisualization(), mrpt::graphslam::detail::TNodeProps< GRAPH_T >::getAsString(), mrpt::topography::TCoords::getAsString(), mrpt::graphslam::deciders::CIncrementalNodeRegistrationDecider< GRAPH_T >::TParams::getAsString(), mrpt::graphslam::deciders::CFixedIntervalsNRD< GRAPH_T >::TParams::getAsString(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TGetICPEdgeAdParams::getAsString(), mrpt::nav::CWaypointsNavigator::TNavigationParamsWaypoints::getAsText(), mrpt::nav::TWaypoint::getAsText(), mrpt::nav::CAbstractNavigator::TargetInfo::getAsText(), mrpt::nav::TWaypointSequence::getAsText(), mrpt::nav::TWaypointStatus::getAsText(), mrpt::nav::TWaypointStatusSequence::getAsText(), mrpt::hwdrivers::COpenNI2Generic::getConnectedDevices(), mrpt::nav::CPTG_Holo_Blend::getDescription(), mrpt::nav::CPTG_DiffDrive_C::getDescription(), mrpt::obs::CObservationWirelessPower::getDescriptionAsText(), mrpt::obs::CObservationOdometry::getDescriptionAsText(), mrpt::obs::CObservationCANBusJ1939::getDescriptionAsText(), mrpt::obs::CObservationBatteryState::getDescriptionAsText(), mrpt::obs::CObservationBeaconRanges::getDescriptionAsText(), mrpt::obs::CObservationGasSensors::getDescriptionAsText(), mrpt::obs::CObservationImage::getDescriptionAsText(), mrpt::obs::CObservationRange::getDescriptionAsText(), mrpt::obs::CObservationStereoImagesFeatures::getDescriptionAsText(), mrpt::obs::CObservationBearingRange::getDescriptionAsText(), mrpt::obs::CObservationStereoImages::getDescriptionAsText(), mrpt::obs::CObservation::getDescriptionAsText(), mrpt::obs::CObservationIMU::getDescriptionAsText(), mrpt::obs::CObservationRotatingScan::getDescriptionAsText(), mrpt::obs::CActionRobotMovement2D::getDescriptionAsText(), mrpt::obs::CObservation2DRangeScan::getDescriptionAsText(), mrpt::obs::CObservationVelodyneScan::getDescriptionAsText(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::getEdgeSquareError(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::getFC2version(), mrpt::hwdrivers::CJoystick::getJoystickPosition(), mrpt::hwdrivers::CJoystick::getJoysticksCount(), mrpt::comms::net::getLastSocketErrorStr(), mrpt::hwdrivers::CVelodyneScanner::TModelPropertiesFactory::getListKnownModels(), mrpt::hwdrivers::CSwissRanger3DCamera::getMesaLibVersion(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getMinUncertaintyPath(), mrpt::obs::CObservationGPS::getMsgByClass(), mrpt::obs::CObservationGPS::getMsgByType(), mrpt::hwdrivers::CCameraSensor::getNextFrame(), mrpt::hwdrivers::COpenNI2Generic::getNextFrameD(), mrpt::hwdrivers::COpenNI2Generic::getNextFrameRGB(), mrpt::hwdrivers::COpenNI2Generic::getNextFrameRGBD(), mrpt::hwdrivers::CSwissRanger3DCamera::getNextObservation(), mrpt::hwdrivers::CImpinjRFID::getObservation(), mrpt::poses::internal::getPoseFromString(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::getPropsOfNodeID(), mrpt::system::CTimeLogger::getStatsAsText(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::getTreeGraph(), mrpt::gui::CDisplayWindow3D::grabImageGetNextFile(), mrpt::graphs::detail::graph_ops< graph_t >::graph_edge_sqerror(), mrpt::graphs::detail::graph_ops< graph_t >::graph_of_poses_dijkstra_init(), mrpt::opengl::graph_tools::graph_visualize(), mrpt::graphslam::TUncertaintyPath< GRAPH_T >::hasLowerUncertaintyThan(), mrpt::comms::net::http_request(), mrpt::graphs::HypothesisNotFoundException::HypothesisNotFoundException(), mrpt::gui::CDisplayWindowPlots::image(), CAboutBoxBase::information(), CGraphSlamHandler< GRAPH_T >::initEngine(), mrpt::hwdrivers::CRovio::initialize(), mrpt::hwdrivers::CNTRIPEmitter::initialize(), mrpt::hwdrivers::COpenNI2Sensor::initialize(), mrpt::hwdrivers::CVelodyneScanner::initialize(), mrpt::hwdrivers::CCameraSensor::initialize(), mrpt::opengl::CRenderizableShaderTexturedTriangles::initializeTextures(), CGraphSlamHandler< GRAPH_T >::initOutputDir(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initResultsFile(), mrpt::maps::CRandomFieldGridMap2D::TInsertionOptionsCommon::internal_dumpToTextStream_common(), mrpt::nav::CPTG_DiffDrive_CollisionGridBased::internal_initialize(), mrpt::nav::PlannerTPS_VirtualBase::internal_initialize_PTG(), mrpt::nav::PlannerTPS_VirtualBase::internal_loadConfig_PTG(), mrpt::gui::CDisplayWindowPlots::internal_plot(), mrpt::hwdrivers::CVelodyneScanner::internal_receive_UDP_packet(), mrpt::hwdrivers::CVelodyneScanner::internal_send_http_post(), mrpt::system::intervalFormat(), mrpt::hwdrivers::CGPSInterface::JAVAD_sendMessage(), mrpt::hwdrivers::CGPSInterface::legacy_topcon_setup_commands(), mrpt::hwdrivers::CSickLaserSerial::LMS_waitACK(), mrpt::obs::CObservationPointCloud::load(), mrpt::nav::TWaypointSequence::load(), mrpt::maps::CGasConcentrationGridMap2D::load_Gaussian_Wind_Grid_From_File(), mrpt::graphs::detail::graph_ops< graph_t >::load_graph_of_poses_from_text_stream(), mrpt::hwdrivers::C2DRangeFinderAbstract::loadCommonParams(), mrpt::hwdrivers::CBoardSonars::loadConfig_sensorSpecific(), mrpt::hwdrivers::CPhidgetInterfaceKitProximitySensors::loadConfig_sensorSpecific(), mrpt::hwdrivers::CVelodyneScanner::loadConfig_sensorSpecific(), mrpt::hwdrivers::CGPSInterface::loadConfig_sensorSpecific(), mrpt::hwdrivers::CNationalInstrumentsDAQ::loadConfig_sensorSpecific(), mrpt::nav::CReactiveNavigationSystem::loadConfigFile(), mrpt::nav::CReactiveNavigationSystem3D::loadConfigFile(), mrpt::nav::CMultiObjectiveMotionOptimizerBase::TParamsBase::loadFromConfigFile(), mrpt::nav::CHolonomicFullEval::TOptions::loadFromConfigFile(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::OptimizationParams::loadFromConfigFile(), mrpt::maps::TSetOfMetricMapInitializers::loadFromConfigFile(), mrpt::maps::CLandmarksMap::TMapDefinition::loadFromConfigFile_map_specific(), mrpt::vision::TSequenceFeatureObservations::loadFromTextFile(), mrpt::vision::CFeatureList::loadFromTextFile(), mrpt::ros1bridge::MapHdl::loadMap(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::loadParams(), mrpt::nav::CPTG_RobotShape_Polygonal::loadShapeFromConfigFile(), mrpt::hmtslam::CHMTSLAM::LSLAM_process_message_from_AA(), mrpt::hwdrivers::TCaptureOptions_DUO3D::m_camera_ext_params_from_yml(), mrpt::hwdrivers::TCaptureOptions_DUO3D::m_camera_int_params_from_yml(), mrpt::hwdrivers::TCaptureOptions_DUO3D::m_rectify_map_from_yml(), mrpt::math::MATLAB_plotCovariance2D(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::mergeGraph(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::monitorNodeRegistration(), mrpt::system::MRPT_getCompilationDate(), mrpt::opengl::CColorBar::onUpdateBuffers_all(), mrpt::io::CFileGZInputStream::open(), mrpt::io::CFileGZOutputStream::open(), mrpt::hwdrivers::COpenNI2Generic::open(), mrpt::hwdrivers::CNTRIPClient::open(), mrpt::hwdrivers::CImageGrabber_FlyCapture2::open(), mrpt::hwdrivers::COpenNI2Generic::openDevicesBySerialNum(), mrpt::math::CVectorDynamic< KFTYPE >::operator()(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator()(), mrpt::img::CImage::operator()(), mrpt::comms::operator<<(), mrpt::vision::CVideoFileWriter::operator<<(), mrpt::poses::operator<<(), mrpt::math::CMatrixDynamic< mrpt::math::TPoint3D_data< double > >::operator=(), mrpt::math::operator>>(), mrpt::serialization::operator>>(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::config::simpleini::MRPT_IniFileParser::parse_process_var_eval(), mrpt::hwdrivers::CRovio::path_management(), mrpt::hwdrivers::CRovio::pathRename(), mrpt::nav::CAbstractPTGBasedReactive::performNavigationStep(), mrpt::nav::CAbstractNavigator::performNavigationStepNavigating(), mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::gui::CDisplayWindowPlots::plotEllipse(), ply_describe_element(), ply_element_count(), ply_header_complete(), ply_put_element_setup(), mrpt::hwdrivers::CNTRIPClient::private_ntrip_thread(), mrpt::slam::CMetricMapBuilderRBPF::processActionObservation(), mrpt::slam::CMetricMapBuilderICP::processObservation(), mrpt::math::ransac2Dline_distance(), mrpt::config::CConfigFileBase::read_double(), mrpt::config::CConfigFileBase::read_float(), mrpt::config::CConfigFileBase::read_int(), mrpt::config::CConfigFileBase::read_string_first_word(), mrpt::config::CConfigFileBase::read_uint64_t(), CGraphSlamHandler< GRAPH_T >::readConfigFname(), readFileWithPoses(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFile(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::readGTFileRGBD_TUM(), mrpt::serialization::CArchive::ReadObject(), mrpt::config::CConfigFile::readString(), mrpt::config::CConfigFileMemory::readString(), mrpt::hwdrivers::CVelodyneScanner::receivePackets(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t >::registerNewNodeAtEnd(), mrpt::poses::CPoint2D::resize(), mrpt::poses::CPoint3D::resize(), mrpt::img::CImage::resize(), mrpt::poses::CPose2D::resize(), mrpt::poses::CPose3DQuat::resize(), mrpt::poses::CPose3D::resize(), mrpt::apps::CGridMapAlignerApp::run(), mrpt::apps::RawlogGrabberApp::run(), mrpt::apps::ICP_SLAM_App_Base::run(), mrpt::apps::RBPF_SLAM_App_Base::run(), mrpt::apps::KFSLAMApp::Run_KF_SLAM(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::runOneKalmanIteration(), mrpt::nav::TWaypointSequence::save(), mrpt::maps::CGasConcentrationGridMap2D::save_Gaussian_Wind_Grid_To_File(), mrpt::obs::CObservationGasSensors::CMOSmodel::save_log_map(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::maps::CRandomFieldGridMap3D::saveAsCSV(), mrpt::obs::CObservationStereoImagesFeatures::saveFeaturesToTextFile(), mrpt::poses::CPoseInterpolatorBase< 3 >::saveInterpolatedToTextFile(), mrpt::maps::CMultiMetricMap::saveMetricMapRepresentationToFile(), mrpt::poses::CPosePDFParticles::saveParzenPDFToTextFile(), mrpt::img::TCamera::saveToConfigFile(), mrpt::nav::CMultiObjectiveMotionOptimizerBase::TParamsBase::saveToConfigFile(), mrpt::nav::CHolonomicND::TOptions::saveToConfigFile(), mrpt::nav::CHolonomicFullEval::TOptions::saveToConfigFile(), mrpt::nav::CPTG_RobotShape_Polygonal::saveToConfigFile(), mrpt::system::CTimeLogger::saveToCSVFile(), mrpt::system::CTimeLogger::saveToMFile(), mrpt::containers::internal::dynamic_grid_txt_saver::saveToTextFile(), mrpt::poses::CPosePDFGrid::saveToTextFile(), mrpt::poses::CPosePDFParticles::saveToTextFile(), mrpt::poses::CPoseInterpolatorBase< 3 >::saveToTextFile(), mrpt::hwdrivers::CRovio::send_cmd_action(), mrpt::apps::ICP_SLAM_App_Live::SensorThread(), mrpt::nav::CLogFileRecord::serializeFrom(), mrpt::hwdrivers::CGPSInterface::setJAVAD_AIM_mode(), mrpt::hwdrivers::CVelodyneScanner::setLidarOnOff(), mrpt::hwdrivers::CVelodyneScanner::setLidarReturnType(), mrpt::hwdrivers::CVelodyneScanner::setLidarRPM(), mrpt::comms::CServerTCPSocket::setupSocket(), mrpt::nav::PlannerRRT_SE2_TPS::solve(), mrpt::nav::PlannerTPS_VirtualBase::spaceTransformer(), mrpt::nav::PlannerTPS_VirtualBase::spaceTransformerOneDirectionOnly(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::splitPartitionToGroups(), mrpt::system::sprintf_container(), mrpt::containers::sprintf_vector(), mrpt::nav::CReactiveNavigationSystem::STEP1_InitPTGs(), mrpt::nav::CReactiveNavigationSystem3D::STEP1_InitPTGs(), store_item(), TEST(), mrpt::hwdrivers::CCameraSensor::thread_save_images(), mrpt::hwdrivers::CRovio::thread_video(), mrpt::system::timeLocalToString(), mrpt::system::timeToString(), mrpt::system::unitsFormat(), mrpt::graphslam::optimizers::CLevMarqGSO< GRAPH_T >::updateGraphVisualization(), mrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::updateMapPartitionsVisualization(), mrpt::graphslam::deciders::CICPCriteriaERD< GRAPH_T >::updateState(), mrpt::system::os::vsnprintf(), mrpt::hwdrivers::CCANBusReader::waitACK(), mrpt::hwdrivers::CCANBusReader::waitContinuousSampleFrame(), mrpt::hwdrivers::CSickLaserUSB::waitContinuousSampleFrame(), mrpt::hwdrivers::CSickLaserSerial::waitContinuousSampleFrame(), mrpt::config::CConfigFileBase::write(), write_ascii_item(), write_binary_item(), write_scalar_type(), mrpt::gui::CPanelCameraSelection::writeConfigFromVideoSourcePanel(), mrpt::vision::CVideoFileWriter::writeImage(), mrpt::system::COutputLogger::writeLogToFile(), mrpt::config::CConfigFileBase::writeString(), and mrpt::hmtslam::CHMTSLAM::~CHMTSLAM().

Here is the call graph for this function:

◆ make_impl()

template<class T , class... Args>
pimpl<T> mrpt::make_impl ( Args &&...  args)
inline

Definition at line 18 of file pimpl.h.

◆ to_string() [1/3]

template<>
std::string mrpt::to_string ( std::string  v)
inline

Definition at line 41 of file format.h.

◆ to_string() [2/3]

template<>
std::string mrpt::to_string ( bool  v)
inline

Definition at line 46 of file format.h.

◆ to_string() [3/3]

template<>
std::string mrpt::to_string ( const char *  s)
inline

Definition at line 51 of file format.h.

Referenced by to_string().

Here is the caller graph for this function:

Variable Documentation

◆ is_defined_v

template<class T >
constexpr bool mrpt::is_defined_v = is_defined<T>::value
inline

Definition at line 30 of file is_defined.h.




Page generated by Doxygen 1.8.14 for MRPT 2.0.0 Git: b38439d21 Tue Mar 31 19:58:06 2020 +0200 at miƩ abr 1 00:50:30 CEST 2020