Variables | |
gps = gtsam.Point3(lat0, lon0, h0) | |
GPS_NOISE = gtsam.noiseModel.Isotropic.Sigma(3, 0.1) | |
graph = gtsam.NonlinearFactorGraph() | |
int | h0 = 274 |
initial = gtsam.Values() | |
float | lat0 = 33.86998 |
float | lon0 = -84.30626 |
optimizer = gtsam.LevenbergMarquardtOptimizer(graph, initial, params) | |
params = gtsam.LevenbergMarquardtParams() | |
PRIOR_NOISE = gtsam.noiseModel.Isotropic.Sigma(6, 0.25) | |
priorMean = gtsam.Pose3() | |
result = optimizer.optimize() | |
GTSAM Copyright 2010-2018, Georgia Tech Research Corporation, Atlanta, Georgia 30332-0415 All Rights Reserved Authors: Frank Dellaert, et al. (see THANKS for the full author list) See LICENSE for the license information Simple robot motion example, with prior and one GPS measurements Author: Mandy Xie
gtsam.examples.GPSFactorExample.gps = gtsam.Point3(lat0, lon0, h0) |
Definition at line 41 of file GPSFactorExample.py.
gtsam.examples.GPSFactorExample.GPS_NOISE = gtsam.noiseModel.Isotropic.Sigma(3, 0.1) |
Definition at line 29 of file GPSFactorExample.py.
gtsam.examples.GPSFactorExample.graph = gtsam.NonlinearFactorGraph() |
Definition at line 33 of file GPSFactorExample.py.
int gtsam.examples.GPSFactorExample.h0 = 274 |
Definition at line 26 of file GPSFactorExample.py.
gtsam.examples.GPSFactorExample.initial = gtsam.Values() |
Definition at line 47 of file GPSFactorExample.py.
float gtsam.examples.GPSFactorExample.lat0 = 33.86998 |
Definition at line 24 of file GPSFactorExample.py.
float gtsam.examples.GPSFactorExample.lon0 = -84.30626 |
Definition at line 25 of file GPSFactorExample.py.
gtsam.examples.GPSFactorExample.optimizer = gtsam.LevenbergMarquardtOptimizer(graph, initial, params) |
Definition at line 53 of file GPSFactorExample.py.
gtsam.examples.GPSFactorExample.params = gtsam.LevenbergMarquardtParams() |
Definition at line 52 of file GPSFactorExample.py.
gtsam.examples.GPSFactorExample.PRIOR_NOISE = gtsam.noiseModel.Isotropic.Sigma(6, 0.25) |
Definition at line 30 of file GPSFactorExample.py.
gtsam.examples.GPSFactorExample.priorMean = gtsam.Pose3() |
Definition at line 37 of file GPSFactorExample.py.
gtsam.examples.GPSFactorExample.result = optimizer.optimize() |
Definition at line 54 of file GPSFactorExample.py.