Go to the documentation of this file.
8 #ifndef BETWEENFACTORMAXMIX_H_
9 #define BETWEENFACTORMAXMIX_H_
12 #include <Eigen/Eigen>
13 #include <gtsam/config.h>
15 #if GTSAM_VERSION_NUMERIC >= 40100
36 boost::optional<gtsam::Matrix&> H1 = boost::none,
37 boost::optional<gtsam::Matrix&> H2 = boost::none)
const
46 double m1 = this->noiseModel_->distance(
error);
52 #if GTSAM_VERSION_NUMERIC >= 40100
64 if (H1) *H1 = *H1 *
weight;
65 if (H2) *H2 = *H2 *
weight;
const Symbol key1( 'v', 1)
Pose3 g1(Rot3(), Point3(100.0, 0.0, 300.0))
noiseModel::Unit::shared_ptr model2
gtsam::SharedNoiseModel nullHypothesisModel
std::shared_ptr< Gaussian > shared_ptr
void determinant(const MatrixType &m)
const Symbol key2( 'v', 2)
GLM_FUNC_DECL vecType< T, P > sqrt(vecType< T, P > const &x)
Pose3 g2(g1.expmap(h *V1_g1))
void error(const char *str)
noiseModel::Base::shared_ptr SharedNoiseModel
Vector evaluateError(const T &p1, const T &p2, OptionalMatrixType H1, OptionalMatrixType H2) const override
BetweenFactorMaxMix(gtsam::Key key1, gtsam::Key key2, const VALUE &measured, const gtsam::SharedNoiseModel &model, const gtsam::SharedNoiseModel &model2, double w)
#define NoiseModelFactor2
Map< const Matrix< T, Dynamic, Dynamic, ColMajor >, 0, OuterStride<> > matrix(const T *data, int rows, int cols, int stride)
gtsam::Vector evaluateError(const VALUE &p1, const VALUE &p2, boost::optional< gtsam::Matrix & > H1=boost::none, boost::optional< gtsam::Matrix & > H2=boost::none) const
gtsam::BetweenFactor< VALUE > betweenFactor
GLM_FUNC_DECL genType exp(genType const &x)
GLM_FUNC_DECL matType< T, P > inverse(matType< T, P > const &m)
rtabmap
Author(s): Mathieu Labbe
autogenerated on Thu Jul 25 2024 02:50:06