MRPT
2.0.1
|
Virtual base for Kalman Filter (EKF,IEKF,UKF) implementations.
This base class stores the state vector and covariance matrix of the system. It has virtual methods that must be completed by derived classes to address a given filtering problem. The main entry point of the algorithm is CKalmanFilterCapable::runOneKalmanIteration, which should be called AFTER setting the desired filter options in KF_options, as well as any options in the derived class. Note that the main entry point is protected, so derived classes must offer another method more specific to a given problem which, internally, calls runOneKalmanIteration.
For further details and examples, check out the tutorial: http://www.mrpt.org/Kalman_Filters
The Kalman filter algorithms are generic, but this implementation is biased to ease the implementation of SLAM-like problems. However, it can be also applied to many generic problems not related to robotics or SLAM.
The meaning of the template parameters is:
Revisions:
Definition at line 50 of file CKalmanFilterCapable.h.
#include <mrpt/bayes/CKalmanFilterCapable.h>
Public Types | |
using | kftype = KFTYPE |
The numeric type used in the Kalman Filter (default=double) More... | |
using | KFCLASS = CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE > |
My class, in a shorter name! More... | |
using | KFVector = mrpt::math::CVectorDynamic< KFTYPE > |
using | KFMatrix = mrpt::math::CMatrixDynamic< KFTYPE > |
using | KFMatrix_VxV = mrpt::math::CMatrixFixed< KFTYPE, VEH_SIZE, VEH_SIZE > |
using | KFMatrix_OxO = mrpt::math::CMatrixFixed< KFTYPE, OBS_SIZE, OBS_SIZE > |
using | KFMatrix_FxF = mrpt::math::CMatrixFixed< KFTYPE, FEAT_SIZE, FEAT_SIZE > |
using | KFMatrix_AxA = mrpt::math::CMatrixFixed< KFTYPE, ACT_SIZE, ACT_SIZE > |
using | KFMatrix_VxO = mrpt::math::CMatrixFixed< KFTYPE, VEH_SIZE, OBS_SIZE > |
using | KFMatrix_VxF = mrpt::math::CMatrixFixed< KFTYPE, VEH_SIZE, FEAT_SIZE > |
using | KFMatrix_FxV = mrpt::math::CMatrixFixed< KFTYPE, FEAT_SIZE, VEH_SIZE > |
using | KFMatrix_FxO = mrpt::math::CMatrixFixed< KFTYPE, FEAT_SIZE, OBS_SIZE > |
using | KFMatrix_OxF = mrpt::math::CMatrixFixed< KFTYPE, OBS_SIZE, FEAT_SIZE > |
using | KFMatrix_OxV = mrpt::math::CMatrixFixed< KFTYPE, OBS_SIZE, VEH_SIZE > |
using | KFArray_VEH = mrpt::math::CVectorFixed< KFTYPE, VEH_SIZE > |
using | KFArray_ACT = mrpt::math::CVectorFixed< KFTYPE, ACT_SIZE > |
using | KFArray_OBS = mrpt::math::CVectorFixed< KFTYPE, OBS_SIZE > |
using | vector_KFArray_OBS = std::vector< KFArray_OBS > |
using | KFArray_FEAT = mrpt::math::CVectorFixed< KFTYPE, FEAT_SIZE > |
Public Member Functions | |
size_t | getNumberOfLandmarksInTheMap () const |
bool | isMapEmpty () const |
size_t | getStateVectorLength () const |
KFVector & | internal_getXkk () |
KFMatrix & | internal_getPkk () |
void | getLandmarkMean (size_t idx, KFArray_FEAT &feat) const |
Returns the mean of the estimated value of the idx'th landmark (not applicable to non-SLAM problems). More... | |
void | getLandmarkCov (size_t idx, KFMatrix_FxF &feat_cov) const |
Returns the covariance of the idx'th landmark (not applicable to non-SLAM problems). More... | |
CKalmanFilterCapable () | |
~CKalmanFilterCapable () override=default | |
Destructor. More... | |
mrpt::system::CTimeLogger & | getProfiler () |
Static Public Member Functions | |
static constexpr size_t | get_vehicle_size () |
static constexpr size_t | get_observation_size () |
static constexpr size_t | get_feature_size () |
static constexpr size_t | get_action_size () |
static std::array< mrpt::system::TConsoleColor, NUMBER_OF_VERBOSITY_LEVELS > & | logging_levels_to_colors () |
Map from VerbosityLevels to their corresponding mrpt::system::TConsoleColor. More... | |
static std::array< std::string, NUMBER_OF_VERBOSITY_LEVELS > & | logging_levels_to_names () |
Map from VerbosityLevels to their corresponding names. More... | |
Public Attributes | |
TKF_options | KF_options |
Generic options for the Kalman Filter algorithm itself. More... | |
Protected Member Functions | |
void | runOneKalmanIteration () |
The main entry point, executes one complete step: prediction + update. More... | |
Protected Attributes | |
mrpt::system::CTimeLogger | m_timLogger |
VerbosityLevel | m_min_verbosity_level {LVL_INFO} |
Provided messages with VerbosityLevel smaller than this value shall be ignored. More... | |
Kalman filter state | |
KFVector | m_xkk |
The system state vector. More... | |
KFMatrix | m_pkk |
The system full covariance matrix. More... | |
Static Private Member Functions | |
static void | KF_aux_estimate_trans_jacobian (const KFArray_VEH &x, const std::pair< KFCLASS *, KFArray_ACT > &dat, KFArray_VEH &out_x) |
Auxiliary functions for Jacobian numeric estimation. More... | |
static void | KF_aux_estimate_obs_Hx_jacobian (const KFArray_VEH &x, const std::pair< KFCLASS *, size_t > &dat, KFArray_OBS &out_x) |
static void | KF_aux_estimate_obs_Hy_jacobian (const KFArray_FEAT &x, const std::pair< KFCLASS *, size_t > &dat, KFArray_OBS &out_x) |
Private Attributes | |
vector_KFArray_OBS | m_all_predictions |
std::vector< size_t > | m_predictLMidxs |
std::vector< KFMatrix_OxV > | m_Hxs |
The vector of all partial Jacobians dh[i]_dx for each prediction. More... | |
std::vector< KFMatrix_OxF > | m_Hys |
The vector of all partial Jacobians dh[i]_dy[i] for each prediction. More... | |
KFMatrix | m_S |
vector_KFArray_OBS | m_Z |
KFMatrix | m_K |
KFMatrix | m_S_1 |
KFMatrix | m_dh_dx_full_obs |
KFMatrix | m_aux_K_dh_dx |
bool | m_user_didnt_implement_jacobian {true} |
Friends | |
template<size_t VEH_SIZEb, size_t OBS_SIZEb, size_t FEAT_SIZEb, size_t ACT_SIZEb, typename KFTYPEb > | |
void | detail::addNewLandmarks (CKalmanFilterCapable< VEH_SIZEb, OBS_SIZEb, FEAT_SIZEb, ACT_SIZEb, KFTYPEb > &obj, const typename CKalmanFilterCapable< VEH_SIZEb, OBS_SIZEb, FEAT_SIZEb, ACT_SIZEb, KFTYPEb >::vector_KFArray_OBS &Z, const std::vector< int > &data_association, const typename CKalmanFilterCapable< VEH_SIZEb, OBS_SIZEb, FEAT_SIZEb, ACT_SIZEb, KFTYPEb >::KFMatrix_OxO &R) |
Virtual methods for Kalman Filter implementation | |
virtual void | OnInverseObservationModel ([[maybe_unused]] const KFArray_OBS &in_z, [[maybe_unused]] KFArray_FEAT &out_yn, [[maybe_unused]] KFMatrix_FxV &out_dyn_dxv, [[maybe_unused]] KFMatrix_FxO &out_dyn_dhn) const |
If applicable to the given problem, this method implements the inverse observation model needed to extend the "map" with a new "element". More... | |
virtual void | OnInverseObservationModel (const KFArray_OBS &in_z, KFArray_FEAT &out_yn, KFMatrix_FxV &out_dyn_dxv, KFMatrix_FxO &out_dyn_dhn, [[maybe_unused]] KFMatrix_FxF &out_dyn_dhn_R_dyn_dhnT, bool &out_use_dyn_dhn_jacobian) const |
If applicable to the given problem, this method implements the inverse observation model needed to extend the "map" with a new "element". More... | |
virtual void | OnNewLandmarkAddedToMap ([[maybe_unused]] const size_t in_obsIdx, [[maybe_unused]] const size_t in_idxNewFeat) |
If applicable to the given problem, do here any special handling of adding a new landmark to the map. More... | |
virtual void | OnNormalizeStateVector () |
This method is called after the prediction and after the update, to give the user an opportunity to normalize the state vector (eg, keep angles within -pi,pi range) if the application requires it. More... | |
virtual void | OnPostIteration () |
This method is called after finishing one KF iteration and before returning from runOneKalmanIteration(). More... | |
virtual void | OnGetAction (KFArray_ACT &out_u) const =0 |
Must return the action vector u. More... | |
virtual void | OnTransitionModel (const KFArray_ACT &in_u, KFArray_VEH &inout_x, bool &out_skipPrediction) const =0 |
Implements the transition model . More... | |
virtual void | OnTransitionJacobian ([[maybe_unused]] KFMatrix_VxV &out_F) const |
Implements the transition Jacobian . More... | |
virtual void | OnTransitionJacobianNumericGetIncrements (KFArray_VEH &out_increments) const |
Only called if using a numeric approximation of the transition Jacobian, this method must return the increments in each dimension of the vehicle state vector while estimating the Jacobian. More... | |
virtual void | OnTransitionNoise (KFMatrix_VxV &out_Q) const =0 |
Implements the transition noise covariance . More... | |
virtual void | OnPreComputingPredictions ([[maybe_unused]] const vector_KFArray_OBS &in_all_prediction_means, std::vector< size_t > &out_LM_indices_to_predict) const |
This will be called before OnGetObservationsAndDataAssociation to allow the application to reduce the number of covariance landmark predictions to be made. More... | |
virtual void | OnGetObservationNoise (KFMatrix_OxO &out_R) const =0 |
Return the observation NOISE covariance matrix, that is, the model of the Gaussian additive noise of the sensor. More... | |
virtual void | OnGetObservationsAndDataAssociation (vector_KFArray_OBS &out_z, std::vector< int > &out_data_association, const vector_KFArray_OBS &in_all_predictions, const KFMatrix &in_S, const std::vector< size_t > &in_lm_indices_in_S, const KFMatrix_OxO &in_R)=0 |
This is called between the KF prediction step and the update step, and the application must return the observations and, when applicable, the data association between these observations and the current map. More... | |
virtual void | OnObservationModel (const std::vector< size_t > &idx_landmarks_to_predict, vector_KFArray_OBS &out_predictions) const =0 |
Implements the observation prediction . More... | |
virtual void | OnObservationJacobians ([[maybe_unused]] size_t idx_landmark_to_predict, [[maybe_unused]] KFMatrix_OxV &Hx, [[maybe_unused]] KFMatrix_OxF &Hy) const |
Implements the observation Jacobians and (when applicable) . More... | |
virtual void | OnObservationJacobiansNumericGetIncrements (KFArray_VEH &out_veh_increments, KFArray_FEAT &out_feat_increments) const |
Only called if using a numeric approximation of the observation Jacobians, this method must return the increments in each dimension of the vehicle state vector while estimating the Jacobian. More... | |
virtual void | OnSubstractObservationVectors (KFArray_OBS &A, const KFArray_OBS &B) const |
Computes A=A-B, which may need to be re-implemented depending on the topology of the individual scalar components (eg, angles). More... | |
Logging methods | |
bool | logging_enable_console_output {true} |
[Default=true] Set it to false in case you don't want the logged messages to be dumped to the output automatically. More... | |
bool | logging_enable_keep_record {false} |
[Default=false] Enables storing all messages into an internal list. More... | |
void | logStr (const VerbosityLevel level, std::string_view msg_str) const |
Main method to add the specified message string to the logger. More... | |
void | logFmt (const VerbosityLevel level, const char *fmt,...) const MRPT_printf_format_check(3 |
Alternative logging method, which mimics the printf behavior. More... | |
void void | logCond (const VerbosityLevel level, bool cond, const std::string &msg_str) const |
Log the given message only if the condition is satisfied. More... | |
void | setLoggerName (const std::string &name) |
Set the name of the COutputLogger instance. More... | |
std::string | getLoggerName () const |
Return the name of the COutputLogger instance. More... | |
void | setMinLoggingLevel (const VerbosityLevel level) |
Set the minimum logging level for which the incoming logs are going to be taken into account. More... | |
void | setVerbosityLevel (const VerbosityLevel level) |
alias of setMinLoggingLevel() More... | |
VerbosityLevel | getMinLoggingLevel () const |
bool | isLoggingLevelVisible (VerbosityLevel level) const |
void | getLogAsString (std::string &log_contents) const |
Fill the provided string with the contents of the logger's history in std::string representation. More... | |
std::string | getLogAsString () const |
Get the history of COutputLogger instance in a string representation. More... | |
void | writeLogToFile (const std::string *fname_in=nullptr) const |
Write the contents of the COutputLogger instance to an external file. More... | |
void | dumpLogToConsole () const |
Dump the current contents of the COutputLogger instance in the terminal window. More... | |
std::string | getLoggerLastMsg () const |
Return the last Tmsg instance registered in the logger history. More... | |
void | getLoggerLastMsg (std::string &msg_str) const |
Fill inputtted string with the contents of the last message in history. More... | |
void | loggerReset () |
Reset the contents of the logger instance. More... | |
void | logRegisterCallback (output_logger_callback_t userFunc) |
bool | logDeregisterCallback (output_logger_callback_t userFunc) |
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFArray_ACT = mrpt::math::CVectorFixed<KFTYPE, ACT_SIZE> |
Definition at line 256 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFArray_FEAT = mrpt::math::CVectorFixed<KFTYPE, FEAT_SIZE> |
Definition at line 259 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFArray_OBS = mrpt::math::CVectorFixed<KFTYPE, OBS_SIZE> |
Definition at line 257 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFArray_VEH = mrpt::math::CVectorFixed<KFTYPE, VEH_SIZE> |
Definition at line 255 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFCLASS = CKalmanFilterCapable<VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE> |
My class, in a shorter name!
Definition at line 237 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix = mrpt::math::CMatrixDynamic<KFTYPE> |
Definition at line 241 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_AxA = mrpt::math::CMatrixFixed<KFTYPE, ACT_SIZE, ACT_SIZE> |
Definition at line 246 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_FxF = mrpt::math::CMatrixFixed<KFTYPE, FEAT_SIZE, FEAT_SIZE> |
Definition at line 245 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_FxO = mrpt::math::CMatrixFixed<KFTYPE, FEAT_SIZE, OBS_SIZE> |
Definition at line 251 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_FxV = mrpt::math::CMatrixFixed<KFTYPE, FEAT_SIZE, VEH_SIZE> |
Definition at line 250 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_OxF = mrpt::math::CMatrixFixed<KFTYPE, OBS_SIZE, FEAT_SIZE> |
Definition at line 252 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_OxO = mrpt::math::CMatrixFixed<KFTYPE, OBS_SIZE, OBS_SIZE> |
Definition at line 244 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_OxV = mrpt::math::CMatrixFixed<KFTYPE, OBS_SIZE, VEH_SIZE> |
Definition at line 253 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_VxF = mrpt::math::CMatrixFixed<KFTYPE, VEH_SIZE, FEAT_SIZE> |
Definition at line 249 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_VxO = mrpt::math::CMatrixFixed<KFTYPE, VEH_SIZE, OBS_SIZE> |
Definition at line 248 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFMatrix_VxV = mrpt::math::CMatrixFixed<KFTYPE, VEH_SIZE, VEH_SIZE> |
Definition at line 243 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::kftype = KFTYPE |
The numeric type used in the Kalman Filter (default=double)
Definition at line 234 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KFVector = mrpt::math::CVectorDynamic<KFTYPE> |
Definition at line 240 of file CKalmanFilterCapable.h.
using mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::vector_KFArray_OBS = std::vector<KFArray_OBS> |
Definition at line 258 of file CKalmanFilterCapable.h.
|
inline |
Definition at line 589 of file CKalmanFilterCapable.h.
|
overridedefault |
Destructor.
|
inherited |
Dump the current contents of the COutputLogger instance in the terminal window.
Definition at line 190 of file COutputLogger.cpp.
|
inlinestatic |
Definition at line 227 of file CKalmanFilterCapable.h.
|
inlinestatic |
Definition at line 226 of file CKalmanFilterCapable.h.
|
inlinestatic |
Definition at line 225 of file CKalmanFilterCapable.h.
|
inlinestatic |
Definition at line 224 of file CKalmanFilterCapable.h.
|
inline |
Returns the covariance of the idx'th landmark (not applicable to non-SLAM problems).
std::exception | On idx>= getNumberOfLandmarksInTheMap() |
Definition at line 279 of file CKalmanFilterCapable.h.
|
inline |
Returns the mean of the estimated value of the idx'th landmark (not applicable to non-SLAM problems).
std::exception | On idx>= getNumberOfLandmarksInTheMap() |
Definition at line 268 of file CKalmanFilterCapable.h.
|
inherited |
Fill the provided string with the contents of the logger's history in std::string representation.
Definition at line 154 of file COutputLogger.cpp.
|
inherited |
Get the history of COutputLogger instance in a string representation.
Definition at line 159 of file COutputLogger.cpp.
Referenced by mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::getDescriptiveReport().
|
inherited |
Return the last Tmsg instance registered in the logger history.
Definition at line 195 of file COutputLogger.cpp.
References mrpt::system::COutputLogger::TMsg::getAsString().
|
inherited |
Fill inputtted string with the contents of the last message in history.
Definition at line 201 of file COutputLogger.cpp.
|
inherited |
Return the name of the COutputLogger instance.
Definition at line 143 of file COutputLogger.cpp.
|
inlineinherited |
Definition at line 201 of file system/COutputLogger.h.
References mrpt::system::COutputLogger::m_min_verbosity_level.
Referenced by mrpt::apps::RawlogGrabberApp::dump_verbose_info(), mrpt::maps::CRandomFieldGridMap2D::isEnabledVerbose(), mrpt::slam::CMetricMapBuilderRBPF::processActionObservation(), mrpt::apps::CGridMapAlignerApp::run(), mrpt::apps::RBPF_SLAM_App_Base::run(), and mrpt::apps::ICP_SLAM_App_Base::run().
|
inline |
Definition at line 228 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::getLandmarkMean(), and mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnPreComputingPredictions().
|
inline |
Definition at line 596 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::detail::addNewLandmarks().
|
inline |
Definition at line 261 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::detail::getNumberOfLandmarksInMap(), and mrpt::bayes::detail::isMapEmpty().
|
inline |
Definition at line 263 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::detail::addNewLandmarks().
|
inline |
Definition at line 262 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::detail::addNewLandmarks().
|
inlineinherited |
Definition at line 202 of file system/COutputLogger.h.
References mrpt::system::COutputLogger::m_min_verbosity_level.
Referenced by mrpt::slam::CMetricMapBuilderRBPF::processActionObservation(), and mrpt::system::COutputLoggerStreamWrapper::~COutputLoggerStreamWrapper().
|
inline |
Definition at line 232 of file CKalmanFilterCapable.h.
|
staticprivate |
Definition at line 954 of file CKalmanFilterCapable_impl.h.
|
staticprivate |
Definition at line 971 of file CKalmanFilterCapable_impl.h.
|
staticprivate |
Auxiliary functions for Jacobian numeric estimation.
Definition at line 941 of file CKalmanFilterCapable_impl.h.
|
inherited |
Log the given message only if the condition is satisfied.
Definition at line 131 of file COutputLogger.cpp.
|
inherited |
Definition at line 291 of file COutputLogger.cpp.
References getAddress(), and mrpt::system::COutputLogger::m_listCallbacks.
|
inherited |
Alternative logging method, which mimics the printf behavior.
Handy for not having to first use mrpt::format to pass a std::string message to logStr
Definition at line 91 of file COutputLogger.cpp.
Referenced by mrpt::hmtslam::CHMTSLAM::areaAbstraction(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::CICPCriteriaNRD(), mrpt::hmtslam::CTopLCDetector_GridMatching::computeTopologicalObservationModel(), CGraphSlamHandler< GRAPH_T >::execute(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), CGraphSlamHandler< GRAPH_T >::initOutputDir(), CGraphSlamHandler< GRAPH_T >::initVisualization(), mrpt::nav::CNavigatorManualSequence::navigationStep(), mrpt::nav::CAbstractNavigator::performNavigationStepNavigating(), CGraphSlamHandler< GRAPH_T >::readConfigFname(), CGraphSlamHandler< GRAPH_T >::saveResults(), CGraphSlamHandler< GRAPH_T >::setResultsDirName(), mrpt::nav::CReactiveNavigationSystem::STEP1_InitPTGs(), mrpt::hmtslam::CHMTSLAM::thread_3D_viewer(), mrpt::hmtslam::CHMTSLAM::thread_LSLAM(), mrpt::hmtslam::CHMTSLAM::thread_TBI(), and CGraphSlamHandler< GRAPH_T >::~CGraphSlamHandler().
|
inherited |
Reset the contents of the logger instance.
Called upon construction.
Definition at line 206 of file COutputLogger.cpp.
References mrpt::system::LVL_INFO.
|
staticinherited |
Map from VerbosityLevels to their corresponding mrpt::system::TConsoleColor.
Handy for coloring the input based on the verbosity of the message
Definition at line 47 of file COutputLogger.cpp.
References logging_levels_to_colors.
Referenced by mrpt::system::COutputLogger::TMsg::dumpToConsole().
|
staticinherited |
Map from VerbosityLevels to their corresponding names.
Handy for printing the current message VerbosityLevel along with the actual content
Definition at line 60 of file COutputLogger.cpp.
References logging_levels_to_names.
Referenced by mrpt::system::COutputLogger::TMsg::getAsString().
|
inherited |
Definition at line 278 of file COutputLogger.cpp.
References mrpt::system::COutputLogger::m_listCallbacks.
|
inherited |
Main method to add the specified message string to the logger.
Definition at line 72 of file COutputLogger.cpp.
References mrpt::system::COutputLogger::TMsg::body, mrpt::system::COutputLogger::TMsg::dumpToConsole(), mrpt::system::COutputLogger::TMsg::level, mrpt::system::COutputLogger::TMsg::name, and mrpt::system::COutputLogger::TMsg::timestamp.
Referenced by mrpt::slam::PF_implementation< mrpt::math::TPose3D, CMonteCarloLocalization3D, mrpt::bayes::particle_storage_mode::VALUE >::PF_SLAM_implementation_pfAuxiliaryPFStandardAndOptimal(), mrpt::nav::CReactiveNavigationSystem::STEP1_InitPTGs(), mrpt::system::COutputLoggerStreamWrapper::~COutputLoggerStreamWrapper(), and mrpt::system::CTimeLoggerSaveAtDtor::~CTimeLoggerSaveAtDtor().
|
protectedpure virtual |
Must return the action vector u.
out_u | The action vector which will be passed to OnTransitionModel |
|
protectedpure virtual |
Return the observation NOISE covariance matrix, that is, the model of the Gaussian additive noise of the sensor.
out_R | The noise covariance matrix. It might be non diagonal, but it'll usually be. |
|
protectedpure virtual |
This is called between the KF prediction step and the update step, and the application must return the observations and, when applicable, the data association between these observations and the current map.
out_z | N vectors, each for one "observation" of length OBS_SIZE, N being the number of "observations": how many observed landmarks for a map, or just one if not applicable. |
out_data_association | An empty vector or, where applicable, a vector where the i'th element corresponds to the position of the observation in the i'th row of out_z within the system state vector (in the range [0,getNumberOfLandmarksInTheMap()-1]), or -1 if it is a new map element and we want to insert it at the end of this KF iteration. |
in_all_predictions | A vector with the prediction of ALL the landmarks in the map. Note that, in contrast, in_S only comprises a subset of all the landmarks. |
in_S | The full covariance matrix of the observation predictions (i.e. the "innovation covariance matrix"). This is a M*O x M*O matrix with M=length of "in_lm_indices_in_S". |
in_lm_indices_in_S | The indices of the map landmarks (range [0,getNumberOfLandmarksInTheMap()-1]) that can be found in the matrix in_S. |
This method will be called just once for each complete KF iteration.
|
inlinevirtual |
If applicable to the given problem, this method implements the inverse observation model needed to extend the "map" with a new "element".
in_z | The observation vector whose inverse sensor model is to be computed. This is actually one of the vector<> returned by OnGetObservationsAndDataAssociation(). |
out_yn | The F-length vector with the inverse observation model . |
out_dyn_dxv | The Jacobian of the inv. sensor model wrt the robot pose . |
out_dyn_dhn | The Jacobian of the inv. sensor model wrt the observation vector . |
Definition at line 489 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::detail::addNewLandmarks(), and mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnInverseObservationModel().
|
inlinevirtual |
If applicable to the given problem, this method implements the inverse observation model needed to extend the "map" with a new "element".
The uncertainty in the new map feature comes from two parts: one from the vehicle uncertainty (through the out_dyn_dxv Jacobian), and another from the uncertainty in the observation itself. By default, out_use_dyn_dhn_jacobian=true on call, and if it's left at "true", the base KalmanFilter class will compute the uncertainty of the landmark relative position from out_dyn_dhn. Only in some problems (e.g. MonoSLAM), it'll be needed for the application to directly return the covariance matrix out_dyn_dhn_R_dyn_dhnT, which is the equivalent to:
.
but may be computed from additional terms, or whatever needed by the user.
in_z | The observation vector whose inverse sensor model is to be computed. This is actually one of the vector<> returned by OnGetObservationsAndDataAssociation(). |
out_yn | The F-length vector with the inverse observation model . |
out_dyn_dxv | The Jacobian of the inv. sensor model wrt the robot pose . |
out_dyn_dhn | The Jacobian of the inv. sensor model wrt the observation vector . |
out_dyn_dhn_R_dyn_dhnT | See the discussion above. |
Definition at line 540 of file CKalmanFilterCapable.h.
|
inlinevirtual |
If applicable to the given problem, do here any special handling of adding a new landmark to the map.
in_obsIndex | The index of the observation whose inverse sensor is to be computed. It corresponds to the row in in_z where the observation can be found. |
in_idxNewFeat | The index that this new feature will have in the state vector (0:just after the vehicle state, 1: after that,...). Save this number so data association can be done according to these indices. |
Definition at line 562 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::detail::addNewLandmarks().
|
inlinevirtual |
This method is called after the prediction and after the update, to give the user an opportunity to normalize the state vector (eg, keep angles within -pi,pi range) if the application requires it.
Reimplemented in mrpt::slam::CRangeBearingKFSLAM, and mrpt::slam::CRangeBearingKFSLAM2D.
Definition at line 573 of file CKalmanFilterCapable.h.
|
inlineprotectedvirtual |
Implements the observation Jacobians and (when applicable) .
idx_landmark_to_predict | The index of the landmark in the map whose prediction is expected as output. For non SLAM-like problems, this will be zero and the expected output is for the whole state vector. |
Hx | The output Jacobian . |
Hy | The output Jacobian . |
Definition at line 437 of file CKalmanFilterCapable.h.
|
inlineprotectedvirtual |
Only called if using a numeric approximation of the observation Jacobians, this method must return the increments in each dimension of the vehicle state vector while estimating the Jacobian.
Definition at line 449 of file CKalmanFilterCapable.h.
|
protectedpure virtual |
Implements the observation prediction .
idx_landmark_to_predict | The indices of the landmarks in the map whose predictions are expected as output. For non SLAM-like problems, this input value is undefined and the application should just generate one observation for the given problem. |
out_predictions | The predicted observations. |
|
inlinevirtual |
This method is called after finishing one KF iteration and before returning from runOneKalmanIteration().
Definition at line 581 of file CKalmanFilterCapable.h.
|
inlineprotectedvirtual |
This will be called before OnGetObservationsAndDataAssociation to allow the application to reduce the number of covariance landmark predictions to be made.
For example, features which are known to be "out of sight" shouldn't be added to the output list to speed up the calculations.
in_all_prediction_means | The mean of each landmark predictions; the computation or not of the corresponding covariances is what we're trying to determined with this method. |
out_LM_indices_to_predict | The list of landmark indices in the map [0,getNumberOfLandmarksInTheMap()-1] that should be predicted. |
Definition at line 366 of file CKalmanFilterCapable.h.
|
inlineprotectedvirtual |
Computes A=A-B, which may need to be re-implemented depending on the topology of the individual scalar components (eg, angles).
Definition at line 460 of file CKalmanFilterCapable.h.
|
inlineprotectedvirtual |
Implements the transition Jacobian .
out_F | Must return the Jacobian. The returned matrix must be with V being either the size of the whole state vector (for non-SLAM problems) or VEH_SIZE (for SLAM problems). |
Definition at line 328 of file CKalmanFilterCapable.h.
|
inlineprotectedvirtual |
Only called if using a numeric approximation of the transition Jacobian, this method must return the increments in each dimension of the vehicle state vector while estimating the Jacobian.
Definition at line 338 of file CKalmanFilterCapable.h.
|
protectedpure virtual |
Implements the transition model .
in_u | The vector returned by OnGetAction. |
inout_x | At input has , at output must have . |
out_skip | Set this to true if for some reason you want to skip the prediction step (to do not modify either the vector or the covariance). Default:false |
|
protectedpure virtual |
Implements the transition noise covariance .
out_Q | Must return the covariance matrix. The returned matrix must be of the same size than the jacobian from OnTransitionJacobian |
|
protected |
The main entry point, executes one complete step: prediction + update.
It is protected since derived classes must provide a problem-specific entry point for users. The exact order in which this method calls the virtual method is explained in https://www.mrpt.org/Kalman_Filters
Definition at line 28 of file CKalmanFilterCapable_impl.h.
|
inherited |
Set the name of the COutputLogger instance.
Definition at line 138 of file COutputLogger.cpp.
Referenced by mrpt::slam::CMetricMapBuilderICP::CMetricMapBuilderICP(), mrpt::slam::CMetricMapBuilderRBPF::CMetricMapBuilderRBPF(), mrpt::slam::CMonteCarloLocalization2D::CMonteCarloLocalization2D(), mrpt::slam::CMonteCarloLocalization3D::CMonteCarloLocalization3D(), mrpt::apps::ICP_SLAM_App_Base::ICP_SLAM_App_Base(), mrpt::apps::ICP_SLAM_App_Live::ICP_SLAM_App_Live(), mrpt::apps::ICP_SLAM_App_Rawlog::ICP_SLAM_App_Rawlog(), mrpt::graphslam::CWindowManager::initCWindowManager(), mrpt::apps::MonteCarloLocalization_Base::MonteCarloLocalization_Base(), mrpt::apps::RBPF_SLAM_App_Base::RBPF_SLAM_App_Base(), and mrpt::apps::RBPF_SLAM_App_Rawlog::RBPF_SLAM_App_Rawlog().
|
inherited |
Set the minimum logging level for which the incoming logs are going to be taken into account.
String messages with specified VerbosityLevel smaller than the min, will not be outputted to the screen and neither will a record of them be stored in by the COutputLogger instance
Definition at line 144 of file COutputLogger.cpp.
Referenced by mrpt::maps::CRandomFieldGridMap2D::enableVerbose(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), generic_kf_slam_test(), generic_pf_test(), generic_rbpf_slam_test(), mrpt::apps::RawlogGrabberApp::initialize(), mrpt::hwdrivers::CHokuyoURG::initialize(), mrpt::graphslam::deciders::CICPCriteriaNRD< GRAPH_T >::loadParams(), mrpt::apps::CGridMapAlignerApp::run(), mrpt::apps::RBPF_SLAM_App_Base::run(), and mrpt::apps::ICP_SLAM_App_Base::run().
|
inherited |
alias of setMinLoggingLevel()
Definition at line 149 of file COutputLogger.cpp.
Referenced by mrpt::nav::CAbstractNavigator::CAbstractNavigator(), mrpt::slam::CMetricMapBuilderRBPF::CMetricMapBuilderRBPF(), mrpt::comms::CServerTCPSocket::CServerTCPSocket(), mrpt::slam::CMetricMapBuilderRBPF::processActionObservation(), mrpt::math::ransac_detect_2D_lines(), and mrpt::apps::ICP_SLAM_App_Base::run().
|
inherited |
Write the contents of the COutputLogger instance to an external file.
Upon call to this method, COutputLogger dumps the contents of all the logged commands so far to the specified external file. By default the filename is set to ${LOGGERNAME}.log except if the fname parameter is provided
Definition at line 165 of file COutputLogger.cpp.
References ASSERTMSG_, and mrpt::format().
|
friend |
TKF_options mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE >::KF_options |
Generic options for the Kalman Filter algorithm itself.
Definition at line 598 of file CKalmanFilterCapable.h.
|
inherited |
[Default=true] Set it to false in case you don't want the logged messages to be dumped to the output automatically.
Definition at line 240 of file system/COutputLogger.h.
|
inherited |
[Default=false] Enables storing all messages into an internal list.
Definition at line 243 of file system/COutputLogger.h.
|
private |
Definition at line 604 of file CKalmanFilterCapable.h.
|
private |
Definition at line 615 of file CKalmanFilterCapable.h.
|
private |
Definition at line 614 of file CKalmanFilterCapable.h.
|
private |
The vector of all partial Jacobians dh[i]_dx for each prediction.
Definition at line 607 of file CKalmanFilterCapable.h.
|
private |
The vector of all partial Jacobians dh[i]_dy[i] for each prediction.
Definition at line 609 of file CKalmanFilterCapable.h.
|
private |
Definition at line 612 of file CKalmanFilterCapable.h.
|
protectedinherited |
Provided messages with VerbosityLevel smaller than this value shall be ignored.
Definition at line 253 of file system/COutputLogger.h.
Referenced by mrpt::system::COutputLogger::getMinLoggingLevel(), and mrpt::system::COutputLogger::isLoggingLevelVisible().
|
protected |
The system full covariance matrix.
Definition at line 292 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::getLandmarkCov(), and mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::internal_getPkk().
|
private |
Definition at line 605 of file CKalmanFilterCapable.h.
|
private |
Definition at line 610 of file CKalmanFilterCapable.h.
|
private |
Definition at line 613 of file CKalmanFilterCapable.h.
|
protected |
Definition at line 296 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::getProfiler().
|
mutableprivate |
Definition at line 627 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnObservationJacobians(), and mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::OnTransitionJacobian().
|
protected |
The system state vector.
Definition at line 290 of file CKalmanFilterCapable.h.
Referenced by mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::getLandmarkMean(), mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::getStateVectorLength(), and mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >::internal_getXkk().
|
private |
Definition at line 611 of file CKalmanFilterCapable.h.
Page generated by Doxygen 1.8.14 for MRPT 2.0.1 Git: 0fef1a6d7 Fri Apr 3 23:00:21 2020 +0200 at vie abr 3 23:20:28 CEST 2020 |