37 #ifndef LVR2_TYPES_MATRIXTYPES_HPP 38 #define LVR2_TYPES_MATRIXTYPES_HPP 40 #include <Eigen/Dense> 46 using Matrix4RM = Eigen::Matrix<T, 4, 4, Eigen::RowMajor>;
56 using Matrix3RM = Eigen::Matrix<T, 3, 3, Eigen::RowMajor>;
167 Vector4<T> ret(p.coeff(0), p.coeff(1), p.coeff(2), 1.0);
168 ret = transform * ret;
169 return Vector3<T>(ret.coeff(0), ret.coeff(1), ret.coeff(2));
185 #endif // LVR2_TYPES_MATRIXTYPES_HPP Matrix4RM< float > Matrix4fRM
4x4 row major matrix with float scalars
Eigen::Matrix< T, 3, 3 > Rotation
General 3x3 rotation matrix.
Eigen::Matrix4f Matrix4f
Eigen 4x4 matrix, single precision.
Eigen::Vector4f Vector4f
Eigen 4D vector, single precision.
Matrix3RM< float > Matrix3fRM
3x3 row major matrix with float scalars
Extrinsics< float > Extrinsicsf
4x4 extrinsic calibration (single precision)
Eigen::Vector3i Vector3i
Eigen 3D vector, integer.
Distortion< double > Distortiond
Distortion Parameters (double precision)
Eigen::Matrix< T, 2, 1 > Vector2
Eigen 2D vector.
Eigen::Vector3d Vector3d
Eigen 3D vector, double precision.
Eigen::Matrix< T, 3, 3 > Intrinsics
4x4 extrinsic calibration
Rotation< double > Rotationd
Double precision 3x3 rotation matrix.
Transform< double > Transformd
4x4 double precision transformation matrix
Eigen::Matrix< float, 6, 6 > Matrix6f
6D Matrix, single precision
Eigen::Vector3f Vector3f
Eigen 3D vector, single precision.
Eigen::Matrix< T, 3, 1 > Vector3
Eigen 3D vector.
Intrinsics< double > Intrinsicsd
4x4 extrinsic calibration (double precision)
Transform< float > Transformf
4x4 single precision transformation matrix
Vector3< T > multiply(const Transform< T > &transform, const Vector3< T > &p)
Matrix3RM< double > Matrix3dRM
3x3 row major matrix with double scalars
Eigen::Vector4d Vector4d
Eigen 4D vector, double precision.
Eigen::Matrix< double, 6, 6 > Matrix6d
6D matrix double precision
Eigen::Matrix< T, 6, 1 > Distortion
Distortion Parameters.
Eigen::Matrix4d Matrix4d
Eigen 4x4 matrix, double precision.
Eigen::Vector2d Vector2d
Eigen 2D vector, double precision.
Distortion< float > Distortionf
Distortion Parameters (single precision)
Eigen::Matrix< float, 6, 1 > Vector6f
6D vector, single precision
Eigen::Matrix< double, 6, 1 > Vector6d
6D vector double precision
Eigen::Matrix< T, 4, 1 > Vector4
Eigen 4D vector.
Intrinsics< float > Intrinsicsf
4x4 intrinsic calibration (single precision)
Eigen::Vector2f Vector2f
Eigen 2D vector, single precision.
Rotation< float > Rotationf
Single precision 3x3 rotation matrix.
Matrix4RM< double > Matrix4dRM
4x4 row major matrix with double scalars
BaseVector< CoordType > operator*(const Eigen::Matrix< Scalar, 4, 4 > &mat, const BaseVector< CoordType > &normal)
Multiplication operator to support transformation with Eigen matrices. Rotates the normal...
Eigen::Matrix< T, 3, 3, Eigen::RowMajor > Matrix3RM
General alias for row major 3x3 matrices.
Eigen::Matrix< T, 4, 4 > Transform
General 4x4 transformation matrix (4x4)
Eigen::Matrix< T, 4, 4 > Extrinsics
4x4 extrinsic calibration
Extrinsics< double > Extrinsicsd
4x4 extrinsic calibration (double precision)
Eigen::Matrix< T, 4, 4, Eigen::RowMajor > Matrix4RM
General alias for row major 4x4 matrices.