Go to the documentation of this file.
55 inline static constexpr
size_t dimension = 10;
65 R_(
R), r_(r), v_(
v), t_(
t) {}
73 OptionalJacobian<10, 3> H2 = {},
74 OptionalJacobian<10, 3> H3 = {},
75 OptionalJacobian<10, 1> H4 = {});
79 OptionalJacobian<10, 6> H1 = {},
80 OptionalJacobian<10, 3> H2 = {},
81 OptionalJacobian<10, 1> H3 = {});
88 const Rot3&
rotation(OptionalJacobian<3, 10>
H = {})
const;
97 const double&
time(OptionalJacobian<1, 10>
H = {})
const;
117 const double&
t()
const {
return t_; }
131 void print(
const std::string&
s =
"")
const;
164 OptionalJacobian<4, 4> He = {})
const;
174 static Vector10 Logmap(
const Gal3&
g, OptionalJacobian<10, 10> Hg = {});
180 Vector10 Adjoint(
const Vector10& xi_base, OptionalJacobian<10, 10> H_g = {},
181 OptionalJacobian<10, 10> H_xi = {})
const;
185 OptionalJacobian<10, 10> Hxi = {},
186 OptionalJacobian<10, 10> Hy = {});
195 static Matrix10 LogmapDerivative(
const Gal3&
g);
214 #if GTSAM_ENABLE_BOOST_SERIALIZATION
215 friend class boost::serialization::access;
216 template <
class ARCHIVE>
217 void serialize(ARCHIVE& ar,
const unsigned int ) {
218 ar & BOOST_SERIALIZATION_NVP(R_);
219 ar & BOOST_SERIALIZATION_NVP(r_);
220 ar & BOOST_SERIALIZATION_NVP(v_);
221 ar & BOOST_SERIALIZATION_NVP(t_);
set noclip points set clip one set noclip two set bar set border lt lw set xdata set ydata set zdata set x2data set y2data set boxwidth set dummy y set format x g set format y g set format x2 g set format y2 g set format z g set angles radians set nogrid set key title set key left top Right noreverse box linetype linewidth samplen spacing width set nolabel set noarrow set nologscale set logscale x set set pointsize set encoding default set nopolar set noparametric set set set set surface set nocontour set clabel set mapping cartesian set nohidden3d set cntrparam order set cntrparam linear set cntrparam levels auto set cntrparam points set size set set xzeroaxis lt lw set x2zeroaxis lt lw set yzeroaxis lt lw set y2zeroaxis lt lw set tics in set ticslevel set tics set mxtics default set mytics default set mx2tics default set my2tics default set xtics border mirror norotate autofreq set ytics border mirror norotate autofreq set ztics border nomirror norotate autofreq set nox2tics set noy2tics set timestamp bottom norotate set rrange[*:*] noreverse nowriteback set trange[*:*] noreverse nowriteback set urange[*:*] noreverse nowriteback set vrange[*:*] noreverse nowriteback set xlabel matrix size set x2label set timefmt d m y n H
Point3_ translation(const Pose3_ &pose)
static const Pose3 pose(Rot3(Vector3(1, -1, -1).asDiagonal()), Point3(0, 0, 0.5))
const EIGEN_DEVICE_FUNC InverseReturnType inverse() const
Matrix3 R() const
Return rotation matrix (Matrix3)
Array< double, 1, 3 > e(1./3., 0.5, 2.)
std::ostream & operator<<(std::ostream &os, const Dih6 &m)
Vector3 Velocity3
Velocity is currently typedef'd to Vector3.
Chart at origin, uses Expmap/Logmap for Retract/Local.
Vector3 r() const
Return position as Vector3.
ofstream os("timeSchurFactors.csv")
Eigen::Matrix< double, 10, 1 > Vector10
Point2 operator*(double s, const Point2 &p)
multiply with scalar
Eigen::Matrix< double, 10, 10 > Matrix10
Pose2_ Expmap(const Vector3_ &xi)
void print(const Matrix &A, const string &s, ostream &stream)
const Point3 & position(OptionalJacobian< 3, 10 > H={}) const
Both LieGroupTraits and Testable.
Rot3 is a 3D rotation represented as a rotation matrix if the preprocessor symbol GTSAM_USE_QUATERNIO...
const Vector3 & v() const
Return velocity as Vector3.
Velocity3 v_
Velocity in world frame, n_v_b.
Base class and basic functions for Manifold types.
static Gal3 Identity()
Return the identity element.
void g(const string &key, int i)
Gal3()
Default constructor: Identity element.
Map< Matrix< T, Dynamic, Dynamic, ColMajor >, 0, OuterStride<> > matrix(T *data, int rows, int cols, int stride)
Base class and basic functions for Lie types.
Rot3_ rotation(const Pose3_ &pose)
Array< int, Dynamic, 1 > v
The matrix class, also used for vectors and row-vectors.
Point3 r_
Position in world frame, n_r_b.
Gal3(const Rot3 &R, const Point3 &r, const Velocity3 &v, double t)
Construct from attitude, position, velocity, time.
abc_eqf_lib::State< N > M
void adjoint(const MatrixType &m)
const Rot3 & attitude(OptionalJacobian< 3, 10 > H={}) const
Rot3 R_
Rotation world R body.
Rot2 R(Rot2::fromAngle(0.1))
3D Pose manifold SO(3) x R^3 and group SE(3)
const double & t() const
Return time scalar.
Velocity3_ velocity(const NavState_ &X)
gtsam
Author(s):
autogenerated on Wed May 28 2025 03:01:18