Go to the documentation of this file.
11 #ifndef EIGEN_COLPIVOTINGHOUSEHOLDERQR_H
12 #define EIGEN_COLPIVOTINGHOUSEHOLDERQR_H
51 template<
typename _MatrixType>
class ColPivHouseholderQR
52 :
public SolverBase<ColPivHouseholderQR<_MatrixType> >
125 template<
typename InputType>
146 template<
typename InputType>
161 #ifdef EIGEN_PARSED_BY_DOXYGEN
176 template<
typename Rhs>
210 template<
typename InputType>
417 #ifndef EIGEN_PARSED_BY_DOXYGEN
418 template<
typename RhsType,
typename DstType>
419 void _solve_impl(
const RhsType &rhs, DstType &dst)
const;
421 template<
bool Conjugate,
typename RhsType,
typename DstType>
449 template<
typename MatrixType>
453 eigen_assert(m_isInitialized &&
"ColPivHouseholderQR is not initialized.");
454 eigen_assert(m_qr.rows() == m_qr.cols() &&
"You can't take the determinant of a non-square matrix!");
455 return abs(m_qr.diagonal().prod());
458 template<
typename MatrixType>
461 eigen_assert(m_isInitialized &&
"ColPivHouseholderQR is not initialized.");
462 eigen_assert(m_qr.rows() == m_qr.cols() &&
"You can't take the determinant of a non-square matrix!");
463 return m_qr.diagonal().cwiseAbs().array().log().sum();
472 template<
typename MatrixType>
473 template<
typename InputType>
481 template<
typename MatrixType>
484 check_template_parameters();
495 m_hCoeffs.resize(
size);
499 m_colsTranspositions.resize(m_qr.cols());
500 Index number_of_transpositions = 0;
502 m_colNormsUpdated.resize(
cols);
503 m_colNormsDirect.resize(
cols);
507 m_colNormsDirect.coeffRef(k) = m_qr.col(k).norm();
508 m_colNormsUpdated.coeffRef(k) = m_colNormsDirect.coeffRef(k);
514 m_nonzero_pivots =
size;
520 Index biggest_col_index;
522 biggest_col_index += k;
526 if(m_nonzero_pivots==
size && biggest_col_sq_norm < threshold_helper *
RealScalar(
rows-k))
527 m_nonzero_pivots = k;
530 m_colsTranspositions.coeffRef(k) = biggest_col_index;
531 if(k != biggest_col_index) {
532 m_qr.col(k).swap(m_qr.col(biggest_col_index));
533 std::swap(m_colNormsUpdated.coeffRef(k), m_colNormsUpdated.coeffRef(biggest_col_index));
534 std::swap(m_colNormsDirect.coeffRef(k), m_colNormsDirect.coeffRef(biggest_col_index));
535 ++number_of_transpositions;
540 m_qr.col(k).tail(
rows-k).makeHouseholderInPlace(m_hCoeffs.coeffRef(k),
beta);
543 m_qr.coeffRef(k,k) =
beta;
549 m_qr.bottomRightCorner(
rows-k,
cols-k-1)
550 .applyHouseholderOnTheLeft(m_qr.col(k).tail(
rows-k-1), m_hCoeffs.coeffRef(k), &m_temp.coeffRef(k+1));
558 if (m_colNormsUpdated.coeffRef(
j) !=
RealScalar(0)) {
559 RealScalar temp =
abs(m_qr.coeffRef(k,
j)) / m_colNormsUpdated.coeffRef(
j);
562 RealScalar temp2 = temp * numext::abs2<RealScalar>(m_colNormsUpdated.coeffRef(
j) /
563 m_colNormsDirect.coeffRef(
j));
564 if (temp2 <= norm_downdate_threshold) {
567 m_colNormsDirect.coeffRef(
j) = m_qr.col(
j).tail(
rows - k - 1).norm();
568 m_colNormsUpdated.coeffRef(
j) = m_colNormsDirect.coeffRef(
j);
578 m_colsPermutation.applyTranspositionOnTheRight(k,
PermIndexType(m_colsTranspositions.coeff(k)));
580 m_det_pq = (number_of_transpositions%2) ? -1 : 1;
581 m_isInitialized =
true;
584 #ifndef EIGEN_PARSED_BY_DOXYGEN
585 template<
typename _MatrixType>
586 template<
typename RhsType,
typename DstType>
589 const Index nonzero_pivots = nonzeroPivots();
591 if(nonzero_pivots == 0)
597 typename RhsType::PlainObject
c(rhs);
599 c.applyOnTheLeft(householderQ().setLength(nonzero_pivots).
adjoint() );
601 m_qr.topLeftCorner(nonzero_pivots, nonzero_pivots)
602 .template triangularView<Upper>()
603 .solveInPlace(
c.topRows(nonzero_pivots));
605 for(
Index i = 0;
i < nonzero_pivots; ++
i) dst.row(m_colsPermutation.indices().coeff(
i)) =
c.row(
i);
606 for(
Index i = nonzero_pivots;
i <
cols(); ++
i) dst.row(m_colsPermutation.indices().coeff(
i)).
setZero();
609 template<
typename _MatrixType>
610 template<
bool Conjugate,
typename RhsType,
typename DstType>
613 const Index nonzero_pivots = nonzeroPivots();
615 if(nonzero_pivots == 0)
621 typename RhsType::PlainObject
c(m_colsPermutation.transpose()*rhs);
623 m_qr.topLeftCorner(nonzero_pivots, nonzero_pivots)
624 .template triangularView<Upper>()
625 .transpose().template conjugateIf<Conjugate>()
626 .solveInPlace(
c.topRows(nonzero_pivots));
628 dst.topRows(nonzero_pivots) =
c.topRows(nonzero_pivots);
629 dst.bottomRows(
rows()-nonzero_pivots).setZero();
631 dst.applyOnTheLeft(householderQ().setLength(nonzero_pivots).
template conjugateIf<!Conjugate>() );
637 template<
typename DstXprType,
typename MatrixType>
653 template<
typename MatrixType>
655 ::householderQ()
const
657 eigen_assert(m_isInitialized &&
"ColPivHouseholderQR is not initialized.");
665 template<
typename Derived>
674 #endif // EIGEN_COLPIVOTINGHOUSEHOLDERQR_H
RealRowVectorType m_colNormsDirect
Expression of the inverse of another expression.
ColPivHouseholderQR & setThreshold(const RealScalar &threshold)
IntRowVectorType m_colsTranspositions
Namespace containing all symbols from the Eigen library.
Index dimensionOfKernel() const
ColPivHouseholderQR(EigenBase< InputType > &matrix)
Constructs a QR factorization from a given matrix.
const HCoeffsType & hCoeffs() const
Traits::StorageIndex StorageIndex
RealScalar m_prescribedThreshold
internal::plain_row_type< MatrixType >::type RowVectorType
RealRowVectorType m_colNormsUpdated
void _solve_impl_transposed(const RhsType &rhs, DstType &dst) const
EIGEN_DEVICE_FUNC const EIGEN_STRONG_INLINE Abs2ReturnType abs2() const
static void run(DstXprType &dst, const SrcXprType &src, const internal::assign_op< typename DstXprType::Scalar, typename QrType::Scalar > &)
double beta(double a, double b)
ColPivHouseholderQR(const EigenBase< InputType > &matrix)
Constructs a QR factorization from a given matrix.
HouseholderSequence< MatrixType, typename internal::remove_all< typename HCoeffsType::ConjugateReturnType >::type > HouseholderSequenceType
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index cols() const EIGEN_NOEXCEPT
RealScalar maxPivot() const
internal::plain_diag_type< MatrixType >::type HCoeffsType
internal::plain_row_type< MatrixType, Index >::type IntRowVectorType
ColPivHouseholderQR()
Default Constructor.
#define EIGEN_GENERIC_PUBLIC_INTERFACE(Derived)
PermutationType::StorageIndex PermIndexType
ColPivHouseholderQR & compute(const EigenBase< InputType > &matrix)
ColPivHouseholderQR< MatrixType > QrType
Inverse< QrType > SrcXprType
void swap(GeographicLib::NearestNeighbor< dist_t, pos_t, distfun_t > &a, GeographicLib::NearestNeighbor< dist_t, pos_t, distfun_t > &b)
SolverStorage StorageKind
const EIGEN_DEVICE_FUNC XprTypeNestedCleaned & nestedExpression() const
const Inverse< ColPivHouseholderQR > inverse() const
Complete orthogonal decomposition (COD) of a matrix.
ComputationInfo info() const
Reports whether the QR factorization was successful.
EIGEN_DONT_INLINE void compute(Solver &solver, const MatrixType &A)
Householder rank-revealing QR decomposition of a matrix with column-pivoting.
MatrixType::PlainObject PlainObject
Map< Matrix< T, Dynamic, Dynamic, ColMajor >, 0, OuterStride<> > matrix(T *data, int rows, int cols, int stride)
NumTraits< Scalar >::Real RealScalar
Pseudo expression representing a solving operation.
void _solve_impl(const RhsType &rhs, DstType &dst) const
EIGEN_DEVICE_FUNC EIGEN_CONSTEXPR Index rows() const EIGEN_NOEXCEPT
MatrixType::RealScalar logAbsDeterminant() const
MatrixType::RealScalar absDeterminant() const
bool isInvertible() const
const MatrixType & matrixQR() const
Index nonzeroPivots() const
RealScalar threshold() const
PermutationType m_colsPermutation
const MatrixType & matrixR() const
Base class for all dense matrices, vectors, and expressions.
CleanedUpDerType< DerType >::type() min(const AutoDiffScalar< DerType > &x, const T &y)
PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime > PermutationType
bool isSurjective() const
static void check_template_parameters()
HouseholderSequenceType matrixQ() const
ColPivHouseholderQR(Index rows, Index cols)
Default Constructor with memory preallocation.
Holds information about the various numeric (i.e. scalar) types allowed by Eigen.
void adjoint(const MatrixType &m)
internal::nested_eval< T, 1 >::type eval(const T &xpr)
ColPivHouseholderQR & setThreshold(Default_t)
Jet< T, N > sqrt(const Jet< T, N > &f)
HouseholderSequenceType householderQ() const
const PermutationType & colsPermutation() const
bool m_usePrescribedThreshold
A base class for matrix decomposition and solvers.
SolverBase< ColPivHouseholderQR > Base
internal::plain_row_type< MatrixType, RealScalar >::type RealRowVectorType
EIGEN_DEFAULT_DENSE_INDEX_TYPE Index
The Index type as used for the API.
Sequence of Householder reflections acting on subspaces with decreasing size.
#define EIGEN_STATIC_ASSERT_NON_INTEGER(TYPE)
gtsam
Author(s):
autogenerated on Fri Nov 1 2024 03:32:07