55 Matrix6 D_gkxi_gk, D_gkxi_exphxi;
56 Pose3 gkxi = gk.
compose(exphxi, D_gkxi_gk, H3 ? &D_gkxi_exphxi : 0);
58 Matrix6 D_hx_gk1, D_hx_gkxi;
59 Pose3 hx = gkxi.
between(gk1, (H2 || H3) ? &D_hx_gkxi : 0, H1 ? &D_hx_gk1 : 0);
64 if (H1) *H1 = D_log_hx * D_hx_gk1;
66 Matrix6 D_log_gkxi = D_log_hx * D_hx_gkxi;
67 if (H2) *H2 = D_log_gkxi * D_gkxi_gk;
68 if (H3) *H3 = D_log_gkxi * D_gkxi_exphxi * D_exphxi_xi *
h_;
101 double mu = 1000.0) :
103 h_(h), Inertia_(Inertia), Fu_(Fu), m_(m) {
121 Vector muk = Inertia_*xik;
122 Vector muk_1 = Inertia_*xik_1;
128 Matrix D_adjThxik_muk, D_adjThxik1_muk1;
134 Vector f_ext = (
Vector(6) << 0.0, 0.0, 0.0, gravityBody.x(), gravityBody.y(), gravityBody.z()).finished();
136 Vector hx = pk - pk_1 - h_*Fu_ - h_*f_ext;
150 insertSub(*H3, -h_*D_gravityBody_gk, 3, 0);
157 Vector computeError(
const Vector6& xik,
const Vector6& xik_1,
const Pose3& gk)
const {
158 Vector pk = Pose3::dExpInv_exp(h_*xik).transpose()*Inertia_*xik;
159 Vector pk_1 = Pose3::dExpInv_exp(-h_*xik_1).transpose()*Inertia_*xik_1;
162 Vector f_ext = (
Vector(6) << 0.0, 0.0, 0.0, gravityBody.x(), gravityBody.y(), gravityBody.z());
164 Vector hx = pk - pk_1 - h_*Fu_ - h_*f_ext;
174 std::function<
Vector(
const Vector6&,
const Vector6&,
const Pose3&)>(
175 std::bind(&DiscreteEulerPoincareHelicopter::computeError, *
this, _1, _2, _3)
182 std::function<
Vector(
const Vector6&,
const Vector6&,
const Pose3&)>(
183 std::bind(&DiscreteEulerPoincareHelicopter::computeError, *
this, _1, _2, _3)
190 std::function<
Vector(
const Vector6&,
const Vector6&,
const Pose3&)>(
191 std::bind(&DiscreteEulerPoincareHelicopter::computeError, *
this, _1, _2, _3)
197 return computeError(xik, xik_1, gk);
static Pose3 Expmap(const Vector6 &xi, OptionalJacobian< 6, 6 > Hxi={})
Exponential map at identity - create a rotation from canonical coordinates .
Reconstruction(Key gKey1, Key gKey, Key xiKey, double h, double mu=1000.0)
static Matrix6 adjointMap(const Vector6 &xi)
gtsam::NonlinearFactor::shared_ptr clone() const override
static Vector6 Logmap(const Pose3 &pose, OptionalJacobian< 6, 6 > Hpose={})
Log map at identity - return the canonical coordinates of this rotation.
virtual Vector evaluateError(const ValueTypes &... x, OptionalMatrixTypeT< ValueTypes >... H) const=0
NoiseModelFactorN< Pose3, Pose3, Vector6 > Base
Some functions to compute numerical derivatives.
~DiscreteEulerPoincareHelicopter() override
gtsam::NonlinearFactor::shared_ptr clone() const override
const SharedNoiseModel & noiseModel() const
access to the noise model
internal::FixedSizeMatrix< Y, X3 >::type numericalDerivative33(std::function< Y(const X1 &, const X2 &, const X3 &)> h, const X1 &x1, const X2 &x2, const X3 &x3, double delta=1e-5)
Matrix * OptionalMatrixType
NoiseModelFactorN< Vector6, Vector6, Pose3 > Base
mass. For gravity external force f_ext, which has a fixed formula in this case.
Point3 unrotate(const Point3 &p, OptionalJacobian< 3, 3 > H1={}, OptionalJacobian< 3, 3 > H2={}) const
rotate point from world to rotated frame
internal::FixedSizeMatrix< Y, X2 >::type numericalDerivative32(std::function< Y(const X1 &, const X2 &, const X3 &)> h, const X1 &x1, const X2 &x2, const X3 &x3, double delta=1e-5)
Vector evaluateError(const Pose3 &gk1, const Pose3 &gk, const Vector6 &xik, OptionalMatrixType H1, OptionalMatrixType H2, OptionalMatrixType H3) const override
internal::FixedSizeMatrix< Y, X1 >::type numericalDerivative31(std::function< Y(const X1 &, const X2 &, const X3 &)> h, const X1 &x1, const X2 &x2, const X3 &x3, double delta=1e-5)
Array< double, 1, 3 > e(1./3., 0.5, 2.)
Class compose(const Class &g) const
Vector Fu_
Inertia tensors Inertia = [ J 0; 0 M ].
double error(const Values &c) const override
Non-linear factor base classes.
void insertSub(Eigen::MatrixBase< Derived1 > &fullMatrix, const Eigen::MatrixBase< Derived2 > &subMatrix, size_t i, size_t j)
Class between(const Class &g) const
std::shared_ptr< This > shared_ptr
static Vector6 adjointTranspose(const Vector6 &xi, const Vector6 &y, OptionalJacobian< 6, 6 > Hxi={}, OptionalJacobian< 6, 6 > H_y={})
const Rot3 & rotation(OptionalJacobian< 3, 6 > Hself={}) const
get rotation
~Reconstruction() override
DiscreteEulerPoincareHelicopter(Key xiKey1, Key xiKey_1, Key gKey, double h, const Matrix &Inertia, const Vector &Fu, double m, double mu=1000.0)
std::uint64_t Key
Integer nonlinear key type.
Vector evaluateError(const Vector6 &xik, const Vector6 &xik_1, const Pose3 &gk, OptionalMatrixType H1, OptionalMatrixType H2, OptionalMatrixType H3) const override