PermutationMatrix.h
Go to the documentation of this file.
1 // This file is part of Eigen, a lightweight C++ template library
2 // for linear algebra.
3 //
4 // Copyright (C) 2009 Benoit Jacob <jacob.benoit.1@gmail.com>
5 // Copyright (C) 2009-2015 Gael Guennebaud <gael.guennebaud@inria.fr>
6 //
7 // This Source Code Form is subject to the terms of the Mozilla
8 // Public License v. 2.0. If a copy of the MPL was not distributed
9 // with this file, You can obtain one at http://mozilla.org/MPL/2.0/.
10 
11 #ifndef EIGEN_PERMUTATIONMATRIX_H
12 #define EIGEN_PERMUTATIONMATRIX_H
13 
14 namespace Eigen {
15 
16 namespace internal {
17 
19 
20 } // end namespace internal
21 
45 template<typename Derived>
46 class PermutationBase : public EigenBase<Derived>
47 {
50  public:
51 
52  #ifndef EIGEN_PARSED_BY_DOXYGEN
53  typedef typename Traits::IndicesType IndicesType;
54  enum {
55  Flags = Traits::Flags,
56  RowsAtCompileTime = Traits::RowsAtCompileTime,
57  ColsAtCompileTime = Traits::ColsAtCompileTime,
58  MaxRowsAtCompileTime = Traits::MaxRowsAtCompileTime,
59  MaxColsAtCompileTime = Traits::MaxColsAtCompileTime
60  };
67  using Base::derived;
69  typedef void Scalar;
70  #endif
71 
73  template<typename OtherDerived>
75  {
76  indices() = other.indices();
77  return derived();
78  }
79 
81  template<typename OtherDerived>
83  {
84  setIdentity(tr.size());
85  for(Index k=size()-1; k>=0; --k)
87  return derived();
88  }
89 
90  #ifndef EIGEN_PARSED_BY_DOXYGEN
91 
94  Derived& operator=(const PermutationBase& other)
95  {
96  indices() = other.indices();
97  return derived();
98  }
99  #endif
100 
102  inline Index rows() const { return Index(indices().size()); }
103 
105  inline Index cols() const { return Index(indices().size()); }
106 
108  inline Index size() const { return Index(indices().size()); }
109 
110  #ifndef EIGEN_PARSED_BY_DOXYGEN
111  template<typename DenseDerived>
112  void evalTo(MatrixBase<DenseDerived>& other) const
113  {
114  other.setZero();
115  for (Index i=0; i<rows(); ++i)
116  other.coeffRef(indices().coeff(i),i) = typename DenseDerived::Scalar(1);
117  }
118  #endif
119 
125  {
126  return derived();
127  }
128 
130  const IndicesType& indices() const { return derived().indices(); }
132  IndicesType& indices() { return derived().indices(); }
133 
136  inline void resize(Index newSize)
137  {
138  indices().resize(newSize);
139  }
140 
142  void setIdentity()
143  {
145  for(StorageIndex i = 0; i < n; ++i)
146  indices().coeffRef(i) = i;
147  }
148 
151  void setIdentity(Index newSize)
152  {
153  resize(newSize);
154  setIdentity();
155  }
156 
167  {
168  eigen_assert(i>=0 && j>=0 && i<size() && j<size());
169  for(Index k = 0; k < size(); ++k)
170  {
171  if(indices().coeff(k) == i) indices().coeffRef(k) = StorageIndex(j);
172  else if(indices().coeff(k) == j) indices().coeffRef(k) = StorageIndex(i);
173  }
174  return derived();
175  }
176 
186  {
187  eigen_assert(i>=0 && j>=0 && i<size() && j<size());
188  std::swap(indices().coeffRef(i), indices().coeffRef(j));
189  return derived();
190  }
191 
196  inline InverseReturnType inverse() const
197  { return InverseReturnType(derived()); }
203  { return InverseReturnType(derived()); }
204 
205  /**** multiplication helpers to hopefully get RVO ****/
206 
207 
208 #ifndef EIGEN_PARSED_BY_DOXYGEN
209  protected:
210  template<typename OtherDerived>
212  {
213  for (Index i=0; i<rows();++i) indices().coeffRef(other.indices().coeff(i)) = i;
214  }
215  template<typename Lhs,typename Rhs>
216  void assignProduct(const Lhs& lhs, const Rhs& rhs)
217  {
218  eigen_assert(lhs.cols() == rhs.rows());
219  for (Index i=0; i<rows();++i) indices().coeffRef(i) = lhs.indices().coeff(rhs.indices().coeff(i));
220  }
221 #endif
222 
223  public:
224 
229  template<typename Other>
232 
237  template<typename Other>
239  { return PlainPermutationType(internal::PermPermProduct, *this, other.eval()); }
240 
245  template<typename Other> friend
247  { return PlainPermutationType(internal::PermPermProduct, other.eval(), perm); }
248 
254  {
255  Index res = 1;
256  Index n = size();
258  mask.fill(false);
259  Index r = 0;
260  while(r < n)
261  {
262  // search for the next seed
263  while(r<n && mask[r]) r++;
264  if(r>=n)
265  break;
266  // we got one, let's follow it until we are back to the seed
267  Index k0 = r++;
268  mask.coeffRef(k0) = true;
269  for(Index k=indices().coeff(k0); k!=k0; k=indices().coeff(k))
270  {
271  mask.coeffRef(k) = true;
272  res = -res;
273  }
274  }
275  return res;
276  }
277 
278  protected:
279 
280 };
281 
282 namespace internal {
283 template<int SizeAtCompileTime, int MaxSizeAtCompileTime, typename _StorageIndex>
284 struct traits<PermutationMatrix<SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex> >
285  : traits<Matrix<_StorageIndex,SizeAtCompileTime,SizeAtCompileTime,0,MaxSizeAtCompileTime,MaxSizeAtCompileTime> >
286 {
289  typedef _StorageIndex StorageIndex;
290  typedef void Scalar;
291 };
292 }
293 
307 template<int SizeAtCompileTime, int MaxSizeAtCompileTime, typename _StorageIndex>
308 class PermutationMatrix : public PermutationBase<PermutationMatrix<SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex> >
309 {
312  public:
313 
314  typedef const PermutationMatrix& Nested;
315 
316  #ifndef EIGEN_PARSED_BY_DOXYGEN
319  #endif
320 
322  {}
323 
327  {
329  }
330 
332  template<typename OtherDerived>
334  : m_indices(other.indices()) {}
335 
336  #ifndef EIGEN_PARSED_BY_DOXYGEN
337 
339  inline PermutationMatrix(const PermutationMatrix& other) : m_indices(other.indices()) {}
340  #endif
341 
349  template<typename Other>
351  {}
352 
354  template<typename Other>
356  : m_indices(tr.size())
357  {
358  *this = tr;
359  }
360 
362  template<typename Other>
364  {
365  m_indices = other.indices();
366  return *this;
367  }
368 
370  template<typename Other>
372  {
373  return Base::operator=(tr.derived());
374  }
375 
376  #ifndef EIGEN_PARSED_BY_DOXYGEN
377 
381  {
382  m_indices = other.m_indices;
383  return *this;
384  }
385  #endif
386 
388  const IndicesType& indices() const { return m_indices; }
391 
392 
393  /**** multiplication helpers to hopefully get RVO ****/
394 
395 #ifndef EIGEN_PARSED_BY_DOXYGEN
396  template<typename Other>
398  : m_indices(other.derived().nestedExpression().size())
399  {
401  StorageIndex end = StorageIndex(m_indices.size());
402  for (StorageIndex i=0; i<end;++i)
403  m_indices.coeffRef(other.derived().nestedExpression().indices().coeff(i)) = i;
404  }
405  template<typename Lhs,typename Rhs>
407  : m_indices(lhs.indices().size())
408  {
409  Base::assignProduct(lhs,rhs);
410  }
411 #endif
412 
413  protected:
414 
416 };
417 
418 
419 namespace internal {
420 template<int SizeAtCompileTime, int MaxSizeAtCompileTime, typename _StorageIndex, int _PacketAccess>
421 struct traits<Map<PermutationMatrix<SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex>,_PacketAccess> >
422  : traits<Matrix<_StorageIndex,SizeAtCompileTime,SizeAtCompileTime,0,MaxSizeAtCompileTime,MaxSizeAtCompileTime> >
423 {
426  typedef _StorageIndex StorageIndex;
427  typedef void Scalar;
428 };
429 }
430 
431 template<int SizeAtCompileTime, int MaxSizeAtCompileTime, typename _StorageIndex, int _PacketAccess>
432 class Map<PermutationMatrix<SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex>,_PacketAccess>
433  : public PermutationBase<Map<PermutationMatrix<SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex>,_PacketAccess> >
434 {
437  public:
438 
439  #ifndef EIGEN_PARSED_BY_DOXYGEN
440  typedef typename Traits::IndicesType IndicesType;
442  #endif
443 
444  inline Map(const StorageIndex* indicesPtr)
445  : m_indices(indicesPtr)
446  {}
447 
448  inline Map(const StorageIndex* indicesPtr, Index size)
449  : m_indices(indicesPtr,size)
450  {}
451 
453  template<typename Other>
455  { return Base::operator=(other.derived()); }
456 
458  template<typename Other>
460  { return Base::operator=(tr.derived()); }
461 
462  #ifndef EIGEN_PARSED_BY_DOXYGEN
463 
466  Map& operator=(const Map& other)
467  {
468  m_indices = other.m_indices;
469  return *this;
470  }
471  #endif
472 
474  const IndicesType& indices() const { return m_indices; }
476  IndicesType& indices() { return m_indices; }
477 
478  protected:
479 
481 };
482 
483 template<typename _IndicesType> class TranspositionsWrapper;
484 namespace internal {
485 template<typename _IndicesType>
486 struct traits<PermutationWrapper<_IndicesType> >
487 {
489  typedef void Scalar;
491  typedef _IndicesType IndicesType;
492  enum {
493  RowsAtCompileTime = _IndicesType::SizeAtCompileTime,
494  ColsAtCompileTime = _IndicesType::SizeAtCompileTime,
495  MaxRowsAtCompileTime = IndicesType::MaxSizeAtCompileTime,
496  MaxColsAtCompileTime = IndicesType::MaxSizeAtCompileTime,
497  Flags = 0
498  };
499 };
500 }
501 
513 template<typename _IndicesType>
514 class PermutationWrapper : public PermutationBase<PermutationWrapper<_IndicesType> >
515 {
518  public:
519 
520  #ifndef EIGEN_PARSED_BY_DOXYGEN
521  typedef typename Traits::IndicesType IndicesType;
522  #endif
523 
525  : m_indices(indices)
526  {}
527 
530  indices() const { return m_indices; }
531 
532  protected:
533 
534  typename IndicesType::Nested m_indices;
535 };
536 
537 
540 template<typename MatrixDerived, typename PermutationDerived>
541 EIGEN_DEVICE_FUNC
544  const PermutationBase<PermutationDerived>& permutation)
545 {
547  (matrix.derived(), permutation.derived());
548 }
549 
552 template<typename PermutationDerived, typename MatrixDerived>
553 EIGEN_DEVICE_FUNC
554 const Product<PermutationDerived, MatrixDerived, AliasFreeProduct>
557 {
559  (permutation.derived(), matrix.derived());
560 }
561 
562 
563 template<typename PermutationType>
564 class InverseImpl<PermutationType, PermutationStorage>
565  : public EigenBase<Inverse<PermutationType> >
566 {
567  typedef typename PermutationType::PlainPermutationType PlainPermutationType;
569  protected:
571  public:
573  using EigenBase<Inverse<PermutationType> >::derived;
574 
575  #ifndef EIGEN_PARSED_BY_DOXYGEN
576  typedef typename PermutationType::DenseMatrixType DenseMatrixType;
577  enum {
578  RowsAtCompileTime = PermTraits::RowsAtCompileTime,
579  ColsAtCompileTime = PermTraits::ColsAtCompileTime,
580  MaxRowsAtCompileTime = PermTraits::MaxRowsAtCompileTime,
581  MaxColsAtCompileTime = PermTraits::MaxColsAtCompileTime
582  };
583  #endif
584 
585  #ifndef EIGEN_PARSED_BY_DOXYGEN
586  template<typename DenseDerived>
587  void evalTo(MatrixBase<DenseDerived>& other) const
588  {
589  other.setZero();
590  for (Index i=0; i<derived().rows();++i)
591  other.coeffRef(i, derived().nestedExpression().indices().coeff(i)) = typename DenseDerived::Scalar(1);
592  }
593  #endif
594 
596  PlainPermutationType eval() const { return derived(); }
597 
598  DenseMatrixType toDenseMatrix() const { return derived(); }
599 
602  template<typename OtherDerived> friend
605  {
606  return Product<OtherDerived, InverseType, AliasFreeProduct>(matrix.derived(), trPerm.derived());
607  }
608 
611  template<typename OtherDerived>
614  {
616  }
617 };
618 
619 template<typename Derived>
621 {
622  return derived();
623 }
624 
625 namespace internal {
626 
628 
629 } // end namespace internal
630 
631 } // end namespace Eigen
632 
633 #endif // EIGEN_PERMUTATIONMATRIX_H
Eigen::internal::traits< PermutationWrapper< _IndicesType > >::StorageKind
PermutationStorage StorageKind
Definition: PermutationMatrix.h:488
Eigen::Inverse
Expression of the inverse of another expression.
Definition: Inverse.h:43
Eigen::InverseImpl< PermutationType, PermutationStorage >::InverseImpl
InverseImpl()
Definition: PermutationMatrix.h:570
Eigen::PermutationBase::MaxColsAtCompileTime
@ MaxColsAtCompileTime
Definition: PermutationMatrix.h:59
Eigen::internal::traits< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::Scalar
void Scalar
Definition: PermutationMatrix.h:427
Eigen::TranspositionsBase
Definition: Transpositions.h:16
Eigen::InverseImpl< PermutationType, PermutationStorage >::InverseType
Inverse< PermutationType > InverseType
Definition: PermutationMatrix.h:572
Eigen
Definition: common.h:73
Eigen::DenseBase::setZero
EIGEN_DEVICE_FUNC Derived & setZero()
Definition: CwiseNullaryOp.h:499
Eigen::PermutationBase::operator=
Derived & operator=(const PermutationBase &other)
Definition: PermutationMatrix.h:94
Eigen::internal::traits< PermutationWrapper< _IndicesType > >::IndicesType
_IndicesType IndicesType
Definition: PermutationMatrix.h:491
Eigen::EigenBase::derived
EIGEN_DEVICE_FUNC Derived & derived()
Definition: EigenBase.h:45
Eigen::internal::traits< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::StorageKind
PermutationStorage StorageKind
Definition: PermutationMatrix.h:287
Eigen::internal::traits< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::IndicesType
Matrix< _StorageIndex, SizeAtCompileTime, 1, 0, MaxSizeAtCompileTime, 1 > IndicesType
Definition: PermutationMatrix.h:288
Eigen::InverseImpl< PermutationType, PermutationStorage >::operator*
const friend Product< OtherDerived, InverseType, AliasFreeProduct > operator*(const MatrixBase< OtherDerived > &matrix, const InverseType &trPerm)
Definition: PermutationMatrix.h:604
Eigen::InverseImpl< PermutationType, PermutationStorage >::operator*
const Product< InverseType, OtherDerived, AliasFreeProduct > operator*(const MatrixBase< OtherDerived > &matrix) const
Definition: PermutationMatrix.h:613
Eigen::internal::Rhs
@ Rhs
Definition: TensorContractionMapper.h:18
Eigen::PermutationMatrix::PermutationMatrix
PermutationMatrix(internal::PermPermProduct_t, const Lhs &lhs, const Rhs &rhs)
Definition: PermutationMatrix.h:406
Eigen::PermutationMatrix::indices
IndicesType & indices()
Definition: PermutationMatrix.h:390
Eigen::EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::Index
Eigen::Index Index
The interface type of indices.
Definition: EigenBase.h:38
Eigen::DenseShape
Definition: Constants.h:512
Eigen::PermutationMatrix::indices
const IndicesType & indices() const
Definition: PermutationMatrix.h:388
Eigen::internal::traits< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::Scalar
void Scalar
Definition: PermutationMatrix.h:290
Eigen::PermutationBase::PlainPermutationType
PermutationMatrix< IndicesType::SizeAtCompileTime, IndicesType::MaxSizeAtCompileTime, StorageIndex > PlainPermutationType
Definition: PermutationMatrix.h:65
Eigen::internal::EigenBase2EigenBase
Definition: AssignEvaluator.h:761
Eigen::PermutationBase::DenseMatrixType
Matrix< StorageIndex, RowsAtCompileTime, ColsAtCompileTime, 0, MaxRowsAtCompileTime, MaxColsAtCompileTime > DenseMatrixType
Definition: PermutationMatrix.h:63
Eigen::PermutationMatrix::StorageIndex
Traits::StorageIndex StorageIndex
Definition: PermutationMatrix.h:318
Eigen::PermutationBase::transpose
InverseReturnType transpose() const
Definition: PermutationMatrix.h:202
Eigen::EigenBase
Definition: EigenBase.h:29
Eigen::PermutationMatrix::PermutationMatrix
PermutationMatrix(const TranspositionsBase< Other > &tr)
Definition: PermutationMatrix.h:355
eigen_assert
#define eigen_assert(x)
Definition: Macros.h:579
Eigen::PermutationBase::Scalar
void Scalar
Definition: PermutationMatrix.h:69
Eigen::PermutationBase::RowsAtCompileTime
@ RowsAtCompileTime
Definition: PermutationMatrix.h:56
Eigen::PermutationBase::cols
Index cols() const
Definition: PermutationMatrix.h:105
Eigen::TranspositionsBase::coeff
const StorageIndex & coeff(Index i) const
Definition: Transpositions.h:56
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::operator=
Map & operator=(const PermutationBase< Other > &other)
Definition: PermutationMatrix.h:454
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::StorageIndex
IndicesType::Scalar StorageIndex
Definition: PermutationMatrix.h:441
Eigen::PermutationWrapper::IndicesType
Traits::IndicesType IndicesType
Definition: PermutationMatrix.h:521
Eigen::internal::PermPermProduct_t
PermPermProduct_t
Definition: PermutationMatrix.h:18
Eigen::PermutationBase::resize
void resize(Index newSize)
Definition: PermutationMatrix.h:136
Eigen::internal::remove_all::type
T type
Definition: Meta.h:78
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::Traits
internal::traits< Map > Traits
Definition: PermutationMatrix.h:436
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::operator=
Map & operator=(const TranspositionsBase< Other > &tr)
Definition: PermutationMatrix.h:459
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::indices
const IndicesType & indices() const
Definition: PermutationMatrix.h:474
Scalar
SCALAR Scalar
Definition: common.h:84
Eigen::PermutationMatrix::PermutationMatrix
PermutationMatrix(const PermutationMatrix &other)
Definition: PermutationMatrix.h:339
Eigen::PermutationBase::setIdentity
void setIdentity(Index newSize)
Definition: PermutationMatrix.h:151
matrix
Map< Matrix< T, Dynamic, Dynamic, ColMajor >, 0, OuterStride<> > matrix(T *data, int rows, int cols, int stride)
Definition: common.h:102
Eigen::TranspositionsBase::derived
Derived & derived()
Definition: Transpositions.h:26
Eigen::InverseImpl< PermutationType, PermutationStorage >::toDenseMatrix
DenseMatrixType toDenseMatrix() const
Definition: PermutationMatrix.h:598
Eigen::PermutationBase::StorageIndex
Traits::StorageIndex StorageIndex
Definition: PermutationMatrix.h:61
Eigen::operator*
const EIGEN_DEVICE_FUNC Product< MatrixDerived, PermutationDerived, AliasFreeProduct > operator*(const MatrixBase< MatrixDerived > &matrix, const PermutationBase< PermutationDerived > &permutation)
Definition: PermutationMatrix.h:543
eigen_internal_assert
#define eigen_internal_assert(x)
Definition: Macros.h:585
Eigen::PermutationBase::Base
EigenBase< Derived > Base
Definition: PermutationMatrix.h:49
Eigen::PermutationMatrix::PermutationMatrix
PermutationMatrix()
Definition: PermutationMatrix.h:321
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::indices
IndicesType & indices()
Definition: PermutationMatrix.h:476
Eigen::MatrixBase::asPermutation
const PermutationWrapper< const Derived > asPermutation() const
Definition: PermutationMatrix.h:620
Eigen::InverseImpl
Definition: Inverse.h:15
Eigen::PermutationWrapper::Base
PermutationBase< PermutationWrapper > Base
Definition: PermutationMatrix.h:516
Eigen::PermutationBase::rows
Index rows() const
Definition: PermutationMatrix.h:102
Eigen::PermutationBase::operator=
Derived & operator=(const PermutationBase< OtherDerived > &other)
Definition: PermutationMatrix.h:74
Eigen::PermutationBase::applyTranspositionOnTheLeft
Derived & applyTranspositionOnTheLeft(Index i, Index j)
Definition: PermutationMatrix.h:166
Eigen::PermutationWrapper::PermutationWrapper
PermutationWrapper(const IndicesType &indices)
Definition: PermutationMatrix.h:524
Eigen::PermutationBase::size
Index size() const
Definition: PermutationMatrix.h:108
Eigen::PermutationWrapper
Class to view a vector of integers as a permutation matrix.
Definition: PermutationMatrix.h:514
Eigen::PermutationBase::MaxRowsAtCompileTime
@ MaxRowsAtCompileTime
Definition: PermutationMatrix.h:58
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::Base
PermutationBase< Map > Base
Definition: PermutationMatrix.h:435
Eigen::InverseImpl< PermutationType, PermutationStorage >::eval
PlainPermutationType eval() const
Definition: PermutationMatrix.h:596
Eigen::InverseImpl< PermutationType, PermutationStorage >::evalTo
void evalTo(MatrixBase< DenseDerived > &other) const
Definition: PermutationMatrix.h:587
Eigen::internal::PermPermProduct
@ PermPermProduct
Definition: PermutationMatrix.h:18
Eigen::internal::traits< PermutationWrapper< _IndicesType > >::Scalar
void Scalar
Definition: PermutationMatrix.h:489
Eigen::InverseImpl< PermutationType, PermutationStorage >::PlainPermutationType
PermutationType::PlainPermutationType PlainPermutationType
Definition: PermutationMatrix.h:567
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::IndicesType
Traits::IndicesType IndicesType
Definition: PermutationMatrix.h:440
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::m_indices
IndicesType m_indices
Definition: PermutationMatrix.h:480
Eigen::PermutationBase::indices
const IndicesType & indices() const
Definition: PermutationMatrix.h:130
Eigen::PermutationMatrix::m_indices
IndicesType m_indices
Definition: PermutationMatrix.h:415
Eigen::internal::traits< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::IndicesType
Map< const Matrix< _StorageIndex, SizeAtCompileTime, 1, 0, MaxSizeAtCompileTime, 1 >, _PacketAccess > IndicesType
Definition: PermutationMatrix.h:425
Eigen::PermutationMatrix::operator=
PermutationMatrix & operator=(const TranspositionsBase< Other > &tr)
Definition: PermutationMatrix.h:371
Eigen::PermutationBase::operator*
PlainPermutationType operator*(const InverseImpl< Other, PermutationStorage > &other) const
Definition: PermutationMatrix.h:238
Eigen::PermutationBase::assignTranspose
void assignTranspose(const PermutationBase< OtherDerived > &other)
Definition: PermutationMatrix.h:211
Eigen::PermutationBase::evalTo
void evalTo(MatrixBase< DenseDerived > &other) const
Definition: PermutationMatrix.h:112
Eigen::TranspositionsBase::size
Index size() const
Definition: Transpositions.h:49
Eigen::Product
Expression of the product of two arbitrary matrices or vectors.
Definition: Product.h:71
Eigen::PermutationBase::inverse
InverseReturnType inverse() const
Definition: PermutationMatrix.h:196
Eigen::Matrix::coeffRef
EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE Scalar & coeffRef(Index rowId, Index colId)
Definition: PlainObjectBase.h:183
Eigen::internal::traits< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::StorageIndex
_StorageIndex StorageIndex
Definition: PermutationMatrix.h:289
Eigen::Map
A matrix or vector expression mapping an existing array of data.
Definition: Map.h:94
Eigen::InverseImpl::coeff
Scalar coeff(Index row, Index col) const
Eigen::InverseImpl< PermutationType, PermutationStorage >::PermTraits
internal::traits< PermutationType > PermTraits
Definition: PermutationMatrix.h:568
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::Map
Map(const StorageIndex *indicesPtr, Index size)
Definition: PermutationMatrix.h:448
Eigen::PermutationBase::toDenseMatrix
DenseMatrixType toDenseMatrix() const
Definition: PermutationMatrix.h:124
Eigen::PermutationBase::ColsAtCompileTime
@ ColsAtCompileTime
Definition: PermutationMatrix.h:57
Eigen::PermutationMatrix::operator=
PermutationMatrix & operator=(const PermutationMatrix &other)
Definition: PermutationMatrix.h:380
Eigen::PermutationBase::assignProduct
void assignProduct(const Lhs &lhs, const Rhs &rhs)
Definition: PermutationMatrix.h:216
Eigen::PermutationBase::determinant
Index determinant() const
Definition: PermutationMatrix.h:253
Eigen::PermutationWrapper::indices
const internal::remove_all< typename IndicesType::Nested >::type & indices() const
Definition: PermutationMatrix.h:530
Eigen::internal::traits< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::StorageKind
PermutationStorage StorageKind
Definition: PermutationMatrix.h:424
Eigen::PermutationMatrix::PermutationMatrix
PermutationMatrix(Index size)
Definition: PermutationMatrix.h:326
Eigen::PermutationMatrix::PermutationMatrix
PermutationMatrix(const InverseImpl< Other, PermutationStorage > &other)
Definition: PermutationMatrix.h:397
Eigen::PermutationBase::Traits
internal::traits< Derived > Traits
Definition: PermutationMatrix.h:48
Eigen::PermutationMatrix::operator=
PermutationMatrix & operator=(const PermutationBase< Other > &other)
Definition: PermutationMatrix.h:363
Eigen::PermutationBase
Base class for permutations.
Definition: PermutationMatrix.h:46
Eigen::internal::traits< Derived >
Eigen::PermutationStorage
Definition: Constants.h:500
Eigen::PermutationBase::operator*
PlainPermutationType operator*(const PermutationBase< Other > &other) const
Definition: PermutationMatrix.h:230
Eigen::PermutationMatrix::Base
PermutationBase< PermutationMatrix > Base
Definition: PermutationMatrix.h:310
Eigen::PermutationBase::operator*
friend PlainPermutationType operator*(const InverseImpl< Other, PermutationStorage > &other, const PermutationBase &perm)
Definition: PermutationMatrix.h:246
Eigen::internal::traits< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::StorageIndex
_StorageIndex StorageIndex
Definition: PermutationMatrix.h:426
Eigen::PermutationMatrix
Permutation matrix.
Definition: PermutationMatrix.h:308
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::Map
Map(const StorageIndex *indicesPtr)
Definition: PermutationMatrix.h:444
Eigen::PermutationWrapper::m_indices
IndicesType::Nested m_indices
Definition: PermutationMatrix.h:534
utility::tuple::size
static constexpr size_t size(Tuple< Args... > &)
Provides access to the number of elements in a tuple as a compile-time constant expression.
Definition: TensorSyclTuple.h:143
Eigen::Matrix
The matrix class, also used for vectors and row-vectors.
Definition: Matrix.h:178
Eigen::PermutationBase::applyTranspositionOnTheRight
Derived & applyTranspositionOnTheRight(Index i, Index j)
Definition: PermutationMatrix.h:185
Eigen::PermutationBase::Flags
@ Flags
Definition: PermutationMatrix.h:55
internal
Definition: BandTriangularSolver.h:13
Eigen::internal::Lhs
@ Lhs
Definition: TensorContractionMapper.h:19
Eigen::MatrixBase
Base class for all dense matrices, vectors, and expressions.
Definition: MatrixBase.h:48
n
PlainMatrixType mat * n
Definition: eigenvalues.cpp:41
Eigen::PermutationBase::indices
IndicesType & indices()
Definition: PermutationMatrix.h:132
Eigen::PermutationBase::derived
EIGEN_DEVICE_FUNC Derived & derived()
Definition: EigenBase.h:45
Eigen::PermutationMatrix::IndicesType
Traits::IndicesType IndicesType
Definition: PermutationMatrix.h:317
Eigen::TranspositionsWrapper
Definition: PermutationMatrix.h:483
Eigen::PermutationMatrix::Nested
const typedef PermutationMatrix & Nested
Definition: PermutationMatrix.h:314
Eigen::PermutationMatrix::Traits
internal::traits< PermutationMatrix > Traits
Definition: PermutationMatrix.h:311
swap
int EIGEN_BLAS_FUNC() swap(int *n, RealScalar *px, int *incx, RealScalar *py, int *incy)
Definition: level1_impl.h:152
Eigen::PermutationBase::setIdentity
void setIdentity()
Definition: PermutationMatrix.h:142
Eigen::NumTraits
Holds information about the various numeric (i.e. scalar) types allowed by Eigen.
Definition: NumTraits.h:150
Eigen::PermutationBase::PlainObject
PlainPermutationType PlainObject
Definition: PermutationMatrix.h:66
Eigen::Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess >::operator=
Map & operator=(const Map &other)
Definition: PermutationMatrix.h:466
Eigen::PermutationMatrix::PermutationMatrix
PermutationMatrix(const MatrixBase< Other > &indices)
Definition: PermutationMatrix.h:350
Eigen::PermutationBase::operator=
Derived & operator=(const TranspositionsBase< OtherDerived > &tr)
Definition: PermutationMatrix.h:82
Eigen::PermutationWrapper::Traits
internal::traits< PermutationWrapper > Traits
Definition: PermutationMatrix.h:517
Eigen::internal::AssignmentKind
Definition: AssignEvaluator.h:757
Eigen::internal::traits< PermutationWrapper< _IndicesType > >::StorageIndex
_IndicesType::Scalar StorageIndex
Definition: PermutationMatrix.h:490
Eigen::PermutationMatrix::PermutationMatrix
PermutationMatrix(const PermutationBase< OtherDerived > &other)
Definition: PermutationMatrix.h:333
Eigen::InverseImpl< PermutationType, PermutationStorage >::DenseMatrixType
PermutationType::DenseMatrixType DenseMatrixType
Definition: PermutationMatrix.h:576
Eigen::PermutationBase::IndicesType
Traits::IndicesType IndicesType
Definition: PermutationMatrix.h:53
Eigen::internal::AssignmentKind< DenseShape, PermutationShape >::Kind
EigenBase2EigenBase Kind
Definition: PermutationMatrix.h:627
Eigen::PermutationBase::InverseReturnType
Inverse< Derived > InverseReturnType
Definition: PermutationMatrix.h:68
Eigen::PermutationShape
Definition: Constants.h:519


control_box_rst
Author(s): Christoph Rösmann
autogenerated on Wed Mar 2 2022 00:06:03