Simple linear Kalman filter implemented using factor graphs, i.e., performs Cholesky or QR-based SRIF (Square-Root Information Filter). 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., performs Cholesky or QR-based SRIF (Square-Root Information Filter).
Definition in file KalmanFilter.h.
#define KALMANFILTER_DEFAULT_FACTORIZATION QR |
Definition at line 27 of file KalmanFilter.h.