Functions | |
def | vector3 (x, y, z) |
Variables | |
fig = plt.figure(0) | |
graph = gtsam.NonlinearFactorGraph() | |
initial_estimate = gtsam.Values() | |
marginals = gtsam.Marginals(graph, result) | |
ODOMETRY_NOISE = gtsam.noiseModel.Diagonal.Sigmas(vector3(0.2, 0.2, 0.1)) | |
optimizer = gtsam.GaussNewtonOptimizer(graph, initial_estimate, parameters) | |
parameters = gtsam.GaussNewtonParams() | |
PRIOR_NOISE = gtsam.noiseModel.Diagonal.Sigmas(vector3(0.3, 0.3, 0.1)) | |
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 robotics example using odometry measurements and bearing-range (laser) measurements Author: Alex Cunningham (C++), Kevin Deng & Frank Dellaert (Python)
def gtsam.examples.Pose2SLAMExample.vector3 | ( | x, | |
y, | |||
z | |||
) |
Create 3d double numpy array.
Definition at line 26 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.fig = plt.figure(0) |
Definition at line 91 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.graph = gtsam.NonlinearFactorGraph() |
Definition at line 35 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.initial_estimate = gtsam.Values() |
Definition at line 61 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.marginals = gtsam.Marginals(graph, result) |
Definition at line 87 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.ODOMETRY_NOISE = gtsam.noiseModel.Diagonal.Sigmas(vector3(0.2, 0.2, 0.1)) |
Definition at line 32 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.optimizer = gtsam.GaussNewtonOptimizer(graph, initial_estimate, parameters) |
Definition at line 81 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.parameters = gtsam.GaussNewtonParams() |
Definition at line 74 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.PRIOR_NOISE = gtsam.noiseModel.Diagonal.Sigmas(vector3(0.3, 0.3, 0.1)) |
Definition at line 31 of file Pose2SLAMExample.py.
gtsam.examples.Pose2SLAMExample.result = optimizer.optimize() |
Definition at line 83 of file Pose2SLAMExample.py.