#include <gtsam/nonlinear/PriorFactor.h>
#include <gtsam/slam/BetweenFactor.h>
#include <gtsam/inference/Symbol.h>
#include <gtsam/linear/GaussianBayesNet.h>
#include <gtsam/linear/GaussianFactorGraph.h>
#include <gtsam/linear/NoiseModel.h>
#include <gtsam/geometry/Point2.h>
Go to the source code of this file.
Functions | |
int | main () |
simple linear Kalman filter on a moving 2D point, but done using factor graphs This example manually creates all of the needed data structures
Definition in file elaboratePoint2KalmanFilter.cpp.
int main | ( | void | ) |
Definition at line 35 of file elaboratePoint2KalmanFilter.cpp.