#include <gtsam/nonlinear/ExtendedKalmanFilter.h>
#include <gtsam/inference/Symbol.h>
#include <gtsam/nonlinear/PriorFactor.h>
#include <gtsam/slam/BetweenFactor.h>
#include <gtsam/geometry/Point2.h>
Go to the source code of this file.
Typedefs | |
typedef Point2 | LinearMeasurement |
Functions | |
int | main () |
simple linear Kalman filter on a moving 2D point, but done using factor graphs This example uses the templated ExtendedKalmanFilter class to perform the same operations as in elaboratePoint2KalmanFilter
Definition in file easyPoint2KalmanFilter.cpp.
typedef Point2 LinearMeasurement |
Definition at line 34 of file easyPoint2KalmanFilter.cpp.
int main | ( | void | ) |
Definition at line 36 of file easyPoint2KalmanFilter.cpp.