2 GTSAM Copyright 2010-2018, Georgia Tech Research Corporation, 3 Atlanta, Georgia 30332-0415 5 Authors: Frank Dellaert, et al. (see THANKS for the full author list) 7 See LICENSE for the license information 9 Initialize PoseSLAM with Chordal init 10 Author: Luca Carlone, Frank Dellaert (python port) 14 from __future__
import print_function
30 np.array([1e-6, 1e-6, 1e-6, 1e-4, 1e-4, 1e-4]))
31 firstKey = initial.keys()[0]
32 graph.add(gtsam.PriorFactorPose3(0,
gtsam.Pose3(), priorModel))
40 if __name__ ==
"__main__":
void print(const Matrix &A, const string &s, ostream &stream)
static Values initialize(const NonlinearFactorGraph &graph, const Values &givenGuess, bool useGradient=false)
GraphAndValues readG2o(const std::string &g2oFile, const bool is3D, KernelFunctionType kernelFunctionType)
This function parses a g2o file and stores the measurements into a NonlinearFactorGraph and the initi...
GTSAM_EXPORT std::string findExampleDataFile(const std::string &name)
static shared_ptr Variances(const Vector &variances, bool smart=true)