Simple linear Kalman filter. Implemented using factor graphs, i.e., does Cholesky-based SRIF, really. More...
#include <gtsam/linear/GaussianDensity.h>
#include <gtsam/linear/GaussianFactorGraph.h>
#include <gtsam/linear/NoiseModel.h>
Go to the source code of this file.
Classes | |
class | gtsam::KalmanFilter |
Namespaces | |
gtsam | |
traits | |
Macros | |
#define | KALMANFILTER_DEFAULT_FACTORIZATION QR |
Simple linear Kalman filter. Implemented using factor graphs, i.e., does Cholesky-based SRIF, really.
Definition in file KalmanFilter.h.
#define KALMANFILTER_DEFAULT_FACTORIZATION QR |
Definition at line 27 of file KalmanFilter.h.