23 using namespace gtsam;
28 values.
insert(key, org1_T_org2);
58 double prior_outlier = 0.5;
59 double prior_inlier = 0.5;
67 model_inlier, model_outlier,prior_inlier, prior_outlier);
69 model_inlier, model_outlier,prior_inlier, prior_outlier);
95 double prior_outlier = 0.01;
96 double prior_inlier = 0.99;
99 valA.
insert(keyA, orgA_T_1);
100 valB.
insert(keyB, orgB_T_2);
104 model_inlier, model_outlier,prior_inlier, prior_outlier);
107 values.
insert(key, orgA_T_orgB);
134 double prior_outlier = 0.01;
135 double prior_inlier = 0.99;
138 valA.
insert(keyA, orgA_T_currA);
139 valB.
insert(keyB, orgB_T_currB);
143 model_inlier, model_outlier,prior_inlier, prior_outlier);
146 values.
insert(key, orgA_T_orgB);
182 double prior_outlier = 0.01;
183 double prior_inlier = 0.99;
186 valA.
insert(keyA, orgA_T_currA);
187 valB.
insert(keyB, orgB_T_currB);
191 model_inlier, model_outlier,prior_inlier, prior_outlier);
194 model_inlier, model_outlier,prior_inlier, prior_outlier);
197 model_inlier, model_outlier,prior_inlier, prior_outlier);
200 model_inlier, model_outlier,prior_inlier, prior_outlier);
243 double prior_outlier = 0.5;
244 double prior_inlier = 0.5;
247 valA.
insert(keyA, orgA_T_1);
248 valB.
insert(keyB, orgB_T_2);
252 model_inlier, model_outlier,prior_inlier, prior_outlier);
255 values.
insert(key, orgA_T_orgB);
257 std::vector<gtsam::Matrix> H_actual(1);
260 Matrix H1_actual = H_actual[0];
262 double stepsize = 1.0e-9;
263 Matrix H1_expected = gtsam::numericalDerivative11<Vector, Pose2>(
264 std::bind(&
predictionError, std::placeholders::_1, key, g), orgA_T_orgB,
const gtsam::Symbol key('X', 0)
static const Eigen::MatrixBase< Vector3 >::ConstantReturnType Z_3x1
virtual const Values & optimize()
static int runAllTests(TestResult &result)
A non-templated config holding any types of Manifold-group elements.
Factor Graph consisting of non-linear factors.
const ValueType at(Key j) const
IsDerived< DERIVEDFACTOR > push_back(std::shared_ptr< DERIVEDFACTOR > factor)
Add a factor directly using a shared_ptr.
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
Some functions to compute numerical derivatives.
NonlinearFactorGraph graph
void g(const string &key, int i)
static const SmartProjectionParams params
Array< double, 1, 3 > e(1./3., 0.5, 2.)
Class compose(const Class &g) const
Class between(const Class &g) const
Pose3 g1(Rot3(), Point3(100.0, 0.0, 300.0))
void insert(Key j, const Value &val)
Pose3 g2(g1.expmap(h *V1_g1))
Base class and parameters for nonlinear optimization algorithms.
std::uint64_t Key
Integer nonlinear key type.
noiseModel::Gaussian::shared_ptr SharedGaussian