ecl_linear_algebra
  • Links
    • Rosindex
    • Website
    • Repository
    • Bugtracker
  • C++ API
    • Page Hierarchy
    • Class Hierarchy
    • File Hierarchy
    • Full C++ API
      • Namespaces
        • Namespace ecl
        • Namespace Eigen
        • Namespace Sophus
      • Classes and Structs
        • Template Class Converter< Eigen::Vector3f, Sophus::SE3f >
        • Template Class Converter< Sophus::SE3f, Eigen::Vector3f >
        • Template Class Format< Sophus::SE3f >
        • Template Class FloatMatrixFormatter
        • Template Class MatrixFormatter
        • Template Class MatrixFormatter< Derived, Scalar, typename ecl::enable_if< ecl::is_float< Scalar > >::type >
        • Template Class Interpolator
        • Class PlanarInterpolator
        • Class PlanarRotation2Quaternion
        • Class SE3fFormatter
        • Class SlidingInterpolator
      • Enums
        • Enum AccessorLevels
        • Enum AlignmentType
        • Enum ComputationInfo
        • Enum DecompositionOptions
        • Enum DirectionType
        • Enum EulerAxis
        • Enum NaNPropagationOptions
        • Enum QRPreconditioners
        • Enum SideType
        • Enum StorageOptions
        • Enum TransformTraits
        • Enum UpLoType
      • Functions
        • Function conservativeResize(int, int)
        • Function conservativeResize(int)
        • Function Eigen::bessel_i0
        • Function Eigen::bessel_i0e
        • Function Eigen::bessel_i1
        • Function Eigen::bessel_i1e
        • Function Eigen::bessel_j0
        • Function Eigen::bessel_j1
        • Function Eigen::bessel_k0
        • Function Eigen::bessel_k0e
        • Function Eigen::bessel_k1
        • Function Eigen::bessel_k1e
        • Function Eigen::bessel_y0
        • Function Eigen::bessel_y1
        • Function Eigen::betainc(const ADerived&, const BDerived&, const XDerived&)
        • Function Eigen::betainc(const Eigen::ArrayBase<ArgADerived>&, const Eigen::ArrayBase<ArgBDerived>&, const Eigen::ArrayBase<ArgXDerived>&)
        • Function Eigen::BVIntersect(const BVH&, Intersector&)
        • Function Eigen::BVIntersect(const BVH1&, const BVH2&, Intersector&)
        • Function Eigen::BVMinimize(const BVH&, Minimizer&)
        • Function Eigen::BVMinimize(const BVH1&, const BVH2&, Minimizer&)
        • Function Eigen::cauchy_max_bound
        • Function Eigen::cauchy_min_bound
        • Function Eigen::ChordLengths
        • Function Eigen::createRandomPIMatrixOfRank
        • Function Eigen::fromMsg(const geometry_msgs::msg::Point&, Eigen::Vector3d&)
        • Function Eigen::fromMsg(const geometry_msgs::msg::Pose&, Eigen::Affine3d&)
        • Function Eigen::fromMsg(const geometry_msgs::msg::Pose&, Eigen::Isometry3d&)
        • Function Eigen::fromMsg(const geometry_msgs::msg::Twist&, Eigen::Matrix<double, 6, 1>&)
        • Function Eigen::gamma_sample_der_alpha
        • Function Eigen::householderSequence
        • Function Eigen::igamma
        • Function Eigen::igamma_der_a
        • Function Eigen::igammac
        • Function Eigen::initParallel
        • Function Eigen::klu_solve
        • Function Eigen::KnotAveraging
        • Function Eigen::KnotAveragingWithDerivatives
        • Function Eigen::kroneckerProduct(const MatrixBase<A>&, const MatrixBase<B>&)
        • Function Eigen::kroneckerProduct(const EigenBase<A>&, const EigenBase<B>&)
        • Function Eigen::l1CacheSize
        • Function Eigen::l2CacheSize
        • Function Eigen::l3CacheSize
        • Function Eigen::matrix_sqrt_quasi_triangular
        • Function Eigen::matrix_sqrt_triangular
        • Function Eigen::nbThreads
        • Function Eigen::operator*(const MatrixBase<MatrixDerived>&, const PermutationBase<PermutationDerived>&)
        • Function Eigen::operator*(const PermutationBase<PermutationDerived>&, const MatrixBase<MatrixDerived>&)
        • Function Eigen::operator*(const MatrixBase<MatrixDerived>&, const TranspositionsBase<TranspositionsDerived>&)
        • Function Eigen::operator*(const TranspositionsBase<TranspositionsDerived>&, const MatrixBase<MatrixDerived>&)
        • Function Eigen::operator*(const MatrixBase<OtherDerived>&, const HouseholderSequence<VectorsType, CoeffsType, Side>&)
        • Function Eigen::operator*(const SparseMatrixBase<SparseDerived>&, const PermutationBase<PermDerived>&)
        • Function Eigen::operator*(const PermutationBase<PermDerived>&, const SparseMatrixBase<SparseDerived>&)
        • Function Eigen::operator*(const SparseMatrixBase<SparseDerived>&, const InverseImpl<PermutationType, PermutationStorage>&)
        • Function Eigen::operator*(const InverseImpl<PermutationType, PermutationStorage>&, const SparseMatrixBase<SparseDerived>&)
        • Template Function Eigen::operator<<
        • Function Eigen::poly_eval
        • Function Eigen::poly_eval_horner
        • Function Eigen::polygamma
        • Function Eigen::rightHouseholderSequence
        • Function Eigen::roots_to_monicPolynomial
        • Function Eigen::Scaling(float)
        • Function Eigen::Scaling(double)
        • Function Eigen::Scaling(const std::complex<RealScalar>&)
        • Function Eigen::Scaling(const Scalar&, const Scalar&)
        • Function Eigen::Scaling(const Scalar&, const Scalar&, const Scalar&)
        • Function Eigen::Scaling(const MatrixBase<Derived>&)
        • Function Eigen::seqN(FirstType, SizeType, IncrType)
        • Function Eigen::seqN(FirstType, SizeType)
        • Function Eigen::setCpuCacheSizes
        • Function Eigen::setNbThreads
        • Function Eigen::toMsg(const Eigen::Affine3d&)
        • Function Eigen::toMsg(const Eigen::Isometry3d&)
        • Function Eigen::toMsg(const Eigen::Vector3d&)
        • Function Eigen::toMsg(const Eigen::Quaterniond&)
        • Function Eigen::toMsg(const Eigen::Matrix<double, 6, 1>&)
        • Function Eigen::umeyama
        • Function Eigen::viewAsCholmod(Ref<SparseMatrix<_Scalar, _Options, _StorageIndex>>)
        • Function Eigen::viewAsCholmod(const SparseSelfAdjointView<const SparseMatrix<_Scalar, _Options, _Index>, UpLo>&)
        • Function Eigen::viewAsCholmod(MatrixBase<Derived>&)
        • Function Eigen::viewAsEigen
        • Function Eigen::zeta
        • Function Sophus::fromMsg(const beluga_ros::msg::Transform&, Sophus::SE2<Scalar>&)
        • Function Sophus::fromMsg(const beluga_ros::msg::Transform&, Sophus::SE3<Scalar>&)
        • Function Sophus::fromMsg(const beluga_ros::msg::Pose&, Sophus::SE2<Scalar>&)
        • Function Sophus::fromMsg(const beluga_ros::msg::Pose&, Sophus::SE3<Scalar>&)
        • Template Function Sophus::operator<<(OutputStream&, SE3fFormatter&)
        • Template Function Sophus::operator<<(std::ostream&, const SE3<T>&)
        • Template Function Sophus::operator<<(std::ostream&, const SE2<T>&)
        • Function Sophus::toMsg(const Sophus::SE2<Scalar>&)
        • Function Sophus::toMsg(const Sophus::SE3<Scalar>&)
        • Function Sophus::toPose2D
        • Function Sophus::toPose3D
      • Variables
        • Variable Eigen::ABx_lx
        • Variable Eigen::Affine
        • Variable Eigen::AffineCompact
        • Variable Eigen::Aligned
        • Variable Eigen::Aligned128
        • Variable Eigen::Aligned16
        • Variable Eigen::Aligned32
        • Variable Eigen::Aligned64
        • Variable Eigen::Aligned8
        • Variable Eigen::AlignedBit
        • Variable Eigen::AutoAlign
        • Variable Eigen::Ax_lBx
        • Variable Eigen::BAx_lx
        • Variable Eigen::BothDirections
        • Variable Eigen::ColMajor
        • Variable Eigen::ColPivHouseholderQRPreconditioner
        • Variable Eigen::CompressedAccessBit
        • Variable Eigen::ComputeEigenvectors
        • Variable Eigen::ComputeFullU
        • Variable Eigen::ComputeFullV
        • Variable Eigen::ComputeThinU
        • Variable Eigen::ComputeThinV
        • Variable Eigen::DirectAccessBit
        • Variable Eigen::DirectAccessors
        • Variable Eigen::DirectWriteAccessors
        • Variable Eigen::DontAlign
        • Variable Eigen::Dynamic
        • Variable Eigen::DynamicIndex
        • Variable Eigen::EigenvaluesOnly
        • Variable Eigen::EULER_X
        • Variable Eigen::EULER_Y
        • Variable Eigen::EULER_Z
        • Variable Eigen::EvalBeforeAssigningBit
        • Variable Eigen::EvalBeforeNestingBit
        • Variable Eigen::FullPivHouseholderQRPreconditioner
        • Variable Eigen::Horizontal
        • Variable Eigen::HouseholderQRPreconditioner
        • Variable Eigen::HugeCost
        • Variable Eigen::Infinity
        • Variable Eigen::InvalidInput
        • Variable Eigen::Isometry
        • Variable Eigen::LinearAccessBit
        • Variable Eigen::Lower
        • Variable Eigen::LvalueBit
        • Variable Eigen::NoConvergence
        • Variable Eigen::NoPreferredStorageOrderBit
        • Variable Eigen::NoQRPreconditioner
        • Variable Eigen::NumericalIssue
        • Variable Eigen::OnTheLeft
        • Variable Eigen::OnTheRight
        • Variable Eigen::PacketAccessBit
        • Variable Eigen::Projective
        • Variable Eigen::PropagateFast
        • Variable Eigen::PropagateNaN
        • Variable Eigen::PropagateNumbers
        • Variable Eigen::ReadOnlyAccessors
        • Variable Eigen::RowMajor
        • Variable Eigen::RowMajorBit
        • Variable Eigen::SelfAdjoint
        • Variable Eigen::StandardCompressedFormat
        • Variable Eigen::StrictlyLower
        • Variable Eigen::StrictlyUpper
        • Variable Eigen::Success
        • Variable Eigen::Symmetric
        • Variable Eigen::Unaligned
        • Variable Eigen::UndefinedIncr
        • Variable Eigen::UnitDiag
        • Variable Eigen::UnitLower
        • Variable Eigen::UnitUpper
        • Variable Eigen::Upper
        • Variable Eigen::Vertical
        • Variable Eigen::WriteAccessors
        • Variable Eigen::ZeroDiag
      • Defines
        • Define EIGEN_MATRIXBASE_PLUGIN
        • Define EIGEN_MATRIXBASE_PLUGIN
      • Typedefs
        • Typedef Eigen::AlignedScaling2d
        • Typedef Eigen::AlignedScaling2f
        • Typedef Eigen::AlignedScaling3d
        • Typedef Eigen::AlignedScaling3f
        • Typedef Eigen::AngleAxisd
        • Typedef Eigen::AngleAxisf
        • Typedef Eigen::Index
        • Typedef Eigen::Quaterniond
        • Typedef Eigen::Quaternionf
        • Typedef Eigen::QuaternionMapAlignedd
        • Typedef Eigen::QuaternionMapAlignedf
        • Typedef Eigen::QuaternionMapd
        • Typedef Eigen::QuaternionMapf
        • Typedef Eigen::Rotation2Dd
        • Typedef Eigen::Rotation2Df
        • Typedef Eigen::Spline2d
        • Typedef Eigen::Spline2f
        • Typedef Eigen::Spline3d
        • Typedef Eigen::Spline3f
        • Typedef Formatter
      • Directories
        • Directory include
        • Directory ecl
        • Directory linear_algebra
        • Directory eigen
        • Directory unsupported
        • Directory sophus
      • Files
        • File eigen.hpp
        • File formatters.hpp
        • File formatters.hpp
        • File helpers.hpp
        • File interpolators.hpp
        • File linear_algebra.hpp
        • File nonlinear_optimization.hpp
        • File numerical_diff.hpp
        • File plugin.hpp
        • File sophus.hpp
      • Pages
        • Todo List
  • Standard Documents
    • PACKAGE
    • CHANGELOG
      • Changelog
        • 0.61.8 (2016-01-10)
        • 0.61.7 (2016-01-09)
        • 0.61.5 (2015-11-24)
        • 0.61.0 (2014-09-12)
  • Index
ecl_linear_algebra
  • ecl_linear_algebra
  • View page source

ecl_linear_algebra

Ecl frontend to a linear matrix package (currently eigen).

  • Links
    • Rosindex
    • Website
    • Repository
    • Bugtracker
  • C++ API
    • Page Hierarchy
    • Class Hierarchy
    • File Hierarchy
    • Full C++ API
  • Standard Documents
    • PACKAGE
    • CHANGELOG
Next

© Copyright The <ecl_linear_algebra> Contributors. License: BSD.

Built with Sphinx using a theme provided by Read the Docs.