GeneralProduct.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) 2006-2008 Benoit Jacob <jacob.benoit.1@gmail.com>
5 // Copyright (C) 2008-2011 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_GENERAL_PRODUCT_H
12 #define EIGEN_GENERAL_PRODUCT_H
13 
14 namespace Eigen {
15 
16 enum {
17  Large = 2,
18  Small = 3
19 };
20 
21 namespace internal {
22 
23 template<int Rows, int Cols, int Depth> struct product_type_selector;
24 
25 template<int Size, int MaxSize> struct product_size_category
26 {
27  enum {
28  #ifndef EIGEN_CUDA_ARCH
29  is_large = MaxSize == Dynamic ||
32  #else
33  is_large = 0,
34  #endif
35  value = is_large ? Large
36  : Size == 1 ? 1
37  : Small
38  };
39 };
40 
41 template<typename Lhs, typename Rhs> struct product_type
42 {
43  typedef typename remove_all<Lhs>::type _Lhs;
44  typedef typename remove_all<Rhs>::type _Rhs;
45  enum {
54  };
55 
56  // the splitting into different lines of code here, introducing the _select enums and the typedef below,
57  // is to work around an internal compiler error with gcc 4.1 and 4.2.
58 private:
59  enum {
63  };
65 
66 public:
67  enum {
70  };
71 #ifdef EIGEN_DEBUG_PRODUCT
72  static void debug()
73  {
74  EIGEN_DEBUG_VAR(Rows);
76  EIGEN_DEBUG_VAR(Depth);
77  EIGEN_DEBUG_VAR(rows_select);
78  EIGEN_DEBUG_VAR(cols_select);
79  EIGEN_DEBUG_VAR(depth_select);
81  }
82 #endif
83 };
84 
85 /* The following allows to select the kind of product at compile time
86  * based on the three dimensions of the product.
87  * This is a compile time mapping from {1,Small,Large}^3 -> {product types} */
88 // FIXME I'm not sure the current mapping is the ideal one.
89 template<int M, int N> struct product_type_selector<M,N,1> { enum { ret = OuterProduct }; };
90 template<int M> struct product_type_selector<M, 1, 1> { enum { ret = LazyCoeffBasedProductMode }; };
91 template<int N> struct product_type_selector<1, N, 1> { enum { ret = LazyCoeffBasedProductMode }; };
92 template<int Depth> struct product_type_selector<1, 1, Depth> { enum { ret = InnerProduct }; };
93 template<> struct product_type_selector<1, 1, 1> { enum { ret = InnerProduct }; };
94 template<> struct product_type_selector<Small,1, Small> { enum { ret = CoeffBasedProductMode }; };
95 template<> struct product_type_selector<1, Small,Small> { enum { ret = CoeffBasedProductMode }; };
96 template<> struct product_type_selector<Small,Small,Small> { enum { ret = CoeffBasedProductMode }; };
97 template<> struct product_type_selector<Small, Small, 1> { enum { ret = LazyCoeffBasedProductMode }; };
98 template<> struct product_type_selector<Small, Large, 1> { enum { ret = LazyCoeffBasedProductMode }; };
99 template<> struct product_type_selector<Large, Small, 1> { enum { ret = LazyCoeffBasedProductMode }; };
100 template<> struct product_type_selector<1, Large,Small> { enum { ret = CoeffBasedProductMode }; };
101 template<> struct product_type_selector<1, Large,Large> { enum { ret = GemvProduct }; };
102 template<> struct product_type_selector<1, Small,Large> { enum { ret = CoeffBasedProductMode }; };
103 template<> struct product_type_selector<Large,1, Small> { enum { ret = CoeffBasedProductMode }; };
104 template<> struct product_type_selector<Large,1, Large> { enum { ret = GemvProduct }; };
105 template<> struct product_type_selector<Small,1, Large> { enum { ret = CoeffBasedProductMode }; };
106 template<> struct product_type_selector<Small,Small,Large> { enum { ret = GemmProduct }; };
107 template<> struct product_type_selector<Large,Small,Large> { enum { ret = GemmProduct }; };
108 template<> struct product_type_selector<Small,Large,Large> { enum { ret = GemmProduct }; };
109 template<> struct product_type_selector<Large,Large,Large> { enum { ret = GemmProduct }; };
110 template<> struct product_type_selector<Large,Small,Small> { enum { ret = CoeffBasedProductMode }; };
111 template<> struct product_type_selector<Small,Large,Small> { enum { ret = CoeffBasedProductMode }; };
112 template<> struct product_type_selector<Large,Large,Small> { enum { ret = GemmProduct }; };
113 
114 } // end namespace internal
115 
116 /***********************************************************************
117 * Implementation of Inner Vector Vector Product
118 ***********************************************************************/
119 
120 // FIXME : maybe the "inner product" could return a Scalar
121 // instead of a 1x1 matrix ??
122 // Pro: more natural for the user
123 // Cons: this could be a problem if in a meta unrolled algorithm a matrix-matrix
124 // product ends up to a row-vector times col-vector product... To tackle this use
125 // case, we could have a specialization for Block<MatrixType,1,1> with: operator=(Scalar x);
126 
127 /***********************************************************************
128 * Implementation of Outer Vector Vector Product
129 ***********************************************************************/
130 
131 /***********************************************************************
132 * Implementation of General Matrix Vector Product
133 ***********************************************************************/
134 
135 /* According to the shape/flags of the matrix we have to distinghish 3 different cases:
136  * 1 - the matrix is col-major, BLAS compatible and M is large => call fast BLAS-like colmajor routine
137  * 2 - the matrix is row-major, BLAS compatible and N is large => call fast BLAS-like rowmajor routine
138  * 3 - all other cases are handled using a simple loop along the outer-storage direction.
139  * Therefore we need a lower level meta selector.
140  * Furthermore, if the matrix is the rhs, then the product has to be transposed.
141  */
142 namespace internal {
143 
144 template<int Side, int StorageOrder, bool BlasCompatible>
146 
147 } // end namespace internal
148 
149 namespace internal {
150 
151 template<typename Scalar,int Size,int MaxSize,bool Cond> struct gemv_static_vector_if;
152 
153 template<typename Scalar,int Size,int MaxSize>
154 struct gemv_static_vector_if<Scalar,Size,MaxSize,false>
155 {
156  EIGEN_STRONG_INLINE Scalar* data() { eigen_internal_assert(false && "should never be called"); return 0; }
157 };
158 
159 template<typename Scalar,int Size>
161 {
162  EIGEN_STRONG_INLINE Scalar* data() { return 0; }
163 };
164 
165 template<typename Scalar,int Size,int MaxSize>
166 struct gemv_static_vector_if<Scalar,Size,MaxSize,true>
167 {
168  enum {
171  };
172  #if EIGEN_MAX_STATIC_ALIGN_BYTES!=0
174  EIGEN_STRONG_INLINE Scalar* data() { return m_data.array; }
175  #else
176  // Some architectures cannot align on the stack,
177  // => let's manually enforce alignment by allocating more data and return the address of the first aligned element.
180  return ForceAlignment
181  ? reinterpret_cast<Scalar*>((internal::UIntPtr(m_data.array) & ~(std::size_t(EIGEN_MAX_ALIGN_BYTES-1))) + EIGEN_MAX_ALIGN_BYTES)
182  : m_data.array;
183  }
184  #endif
185 };
186 
187 // The vector is on the left => transposition
188 template<int StorageOrder, bool BlasCompatible>
189 struct gemv_dense_selector<OnTheLeft,StorageOrder,BlasCompatible>
190 {
191  template<typename Lhs, typename Rhs, typename Dest>
192  static void run(const Lhs &lhs, const Rhs &rhs, Dest& dest, const typename Dest::Scalar& alpha)
193  {
194  Transpose<Dest> destT(dest);
195  enum { OtherStorageOrder = StorageOrder == RowMajor ? ColMajor : RowMajor };
197  ::run(rhs.transpose(), lhs.transpose(), destT, alpha);
198  }
199 };
200 
201 template<> struct gemv_dense_selector<OnTheRight,ColMajor,true>
202 {
203  template<typename Lhs, typename Rhs, typename Dest>
204  static inline void run(const Lhs &lhs, const Rhs &rhs, Dest& dest, const typename Dest::Scalar& alpha)
205  {
206  typedef typename Lhs::Scalar LhsScalar;
207  typedef typename Rhs::Scalar RhsScalar;
208  typedef typename Dest::Scalar ResScalar;
209  typedef typename Dest::RealScalar RealScalar;
210 
211  typedef internal::blas_traits<Lhs> LhsBlasTraits;
212  typedef typename LhsBlasTraits::DirectLinearAccessType ActualLhsType;
213  typedef internal::blas_traits<Rhs> RhsBlasTraits;
214  typedef typename RhsBlasTraits::DirectLinearAccessType ActualRhsType;
215 
217 
218  ActualLhsType actualLhs = LhsBlasTraits::extract(lhs);
219  ActualRhsType actualRhs = RhsBlasTraits::extract(rhs);
220 
221  ResScalar actualAlpha = alpha * LhsBlasTraits::extractScalarFactor(lhs)
222  * RhsBlasTraits::extractScalarFactor(rhs);
223 
224  // make sure Dest is a compile-time vector type (bug 1166)
226 
227  enum {
228  // FIXME find a way to allow an inner stride on the result if packet_traits<Scalar>::size==1
229  // on, the other hand it is good for the cache to pack the vector anyways...
230  EvalToDestAtCompileTime = (ActualDest::InnerStrideAtCompileTime==1),
232  MightCannotUseDest = (!EvalToDestAtCompileTime) || ComplexByReal
233  };
234 
237  RhsScalar compatibleAlpha = get_factor<ResScalar,RhsScalar>::run(actualAlpha);
238 
239  if(!MightCannotUseDest)
240  {
241  // shortcut if we are sure to be able to use dest directly,
242  // this ease the compiler to generate cleaner and more optimzized code for most common cases
244  <Index,LhsScalar,LhsMapper,ColMajor,LhsBlasTraits::NeedToConjugate,RhsScalar,RhsMapper,RhsBlasTraits::NeedToConjugate>::run(
245  actualLhs.rows(), actualLhs.cols(),
246  LhsMapper(actualLhs.data(), actualLhs.outerStride()),
247  RhsMapper(actualRhs.data(), actualRhs.innerStride()),
248  dest.data(), 1,
249  compatibleAlpha);
250  }
251  else
252  {
254 
255  const bool alphaIsCompatible = (!ComplexByReal) || (numext::imag(actualAlpha)==RealScalar(0));
256  const bool evalToDest = EvalToDestAtCompileTime && alphaIsCompatible;
257 
258  ei_declare_aligned_stack_constructed_variable(ResScalar,actualDestPtr,dest.size(),
259  evalToDest ? dest.data() : static_dest.data());
260 
261  if(!evalToDest)
262  {
263  #ifdef EIGEN_DENSE_STORAGE_CTOR_PLUGIN
264  Index size = dest.size();
265  EIGEN_DENSE_STORAGE_CTOR_PLUGIN
266  #endif
267  if(!alphaIsCompatible)
268  {
269  MappedDest(actualDestPtr, dest.size()).setZero();
270  compatibleAlpha = RhsScalar(1);
271  }
272  else
273  MappedDest(actualDestPtr, dest.size()) = dest;
274  }
275 
277  <Index,LhsScalar,LhsMapper,ColMajor,LhsBlasTraits::NeedToConjugate,RhsScalar,RhsMapper,RhsBlasTraits::NeedToConjugate>::run(
278  actualLhs.rows(), actualLhs.cols(),
279  LhsMapper(actualLhs.data(), actualLhs.outerStride()),
280  RhsMapper(actualRhs.data(), actualRhs.innerStride()),
281  actualDestPtr, 1,
282  compatibleAlpha);
283 
284  if (!evalToDest)
285  {
286  if(!alphaIsCompatible)
287  dest.matrix() += actualAlpha * MappedDest(actualDestPtr, dest.size());
288  else
289  dest = MappedDest(actualDestPtr, dest.size());
290  }
291  }
292  }
293 };
294 
295 template<> struct gemv_dense_selector<OnTheRight,RowMajor,true>
296 {
297  template<typename Lhs, typename Rhs, typename Dest>
298  static void run(const Lhs &lhs, const Rhs &rhs, Dest& dest, const typename Dest::Scalar& alpha)
299  {
300  typedef typename Lhs::Scalar LhsScalar;
301  typedef typename Rhs::Scalar RhsScalar;
302  typedef typename Dest::Scalar ResScalar;
303 
304  typedef internal::blas_traits<Lhs> LhsBlasTraits;
305  typedef typename LhsBlasTraits::DirectLinearAccessType ActualLhsType;
306  typedef internal::blas_traits<Rhs> RhsBlasTraits;
307  typedef typename RhsBlasTraits::DirectLinearAccessType ActualRhsType;
308  typedef typename internal::remove_all<ActualRhsType>::type ActualRhsTypeCleaned;
309 
310  typename add_const<ActualLhsType>::type actualLhs = LhsBlasTraits::extract(lhs);
311  typename add_const<ActualRhsType>::type actualRhs = RhsBlasTraits::extract(rhs);
312 
313  ResScalar actualAlpha = alpha * LhsBlasTraits::extractScalarFactor(lhs)
314  * RhsBlasTraits::extractScalarFactor(rhs);
315 
316  enum {
317  // FIXME find a way to allow an inner stride on the result if packet_traits<Scalar>::size==1
318  // on, the other hand it is good for the cache to pack the vector anyways...
319  DirectlyUseRhs = ActualRhsTypeCleaned::InnerStrideAtCompileTime==1
320  };
321 
323 
324  ei_declare_aligned_stack_constructed_variable(RhsScalar,actualRhsPtr,actualRhs.size(),
325  DirectlyUseRhs ? const_cast<RhsScalar*>(actualRhs.data()) : static_rhs.data());
326 
327  if(!DirectlyUseRhs)
328  {
329  #ifdef EIGEN_DENSE_STORAGE_CTOR_PLUGIN
330  Index size = actualRhs.size();
331  EIGEN_DENSE_STORAGE_CTOR_PLUGIN
332  #endif
333  Map<typename ActualRhsTypeCleaned::PlainObject>(actualRhsPtr, actualRhs.size()) = actualRhs;
334  }
335 
339  <Index,LhsScalar,LhsMapper,RowMajor,LhsBlasTraits::NeedToConjugate,RhsScalar,RhsMapper,RhsBlasTraits::NeedToConjugate>::run(
340  actualLhs.rows(), actualLhs.cols(),
341  LhsMapper(actualLhs.data(), actualLhs.outerStride()),
342  RhsMapper(actualRhsPtr, 1),
343  dest.data(), dest.col(0).innerStride(), //NOTE if dest is not a vector at compile-time, then dest.innerStride() might be wrong. (bug 1166)
344  actualAlpha);
345  }
346 };
347 
348 template<> struct gemv_dense_selector<OnTheRight,ColMajor,false>
349 {
350  template<typename Lhs, typename Rhs, typename Dest>
351  static void run(const Lhs &lhs, const Rhs &rhs, Dest& dest, const typename Dest::Scalar& alpha)
352  {
353  EIGEN_STATIC_ASSERT((!nested_eval<Lhs,1>::Evaluate),EIGEN_INTERNAL_COMPILATION_ERROR_OR_YOU_MADE_A_PROGRAMMING_MISTAKE);
354  // TODO if rhs is large enough it might be beneficial to make sure that dest is sequentially stored in memory, otherwise use a temp
355  typename nested_eval<Rhs,1>::type actual_rhs(rhs);
356  const Index size = rhs.rows();
357  for(Index k=0; k<size; ++k)
358  dest += (alpha*actual_rhs.coeff(k)) * lhs.col(k);
359  }
360 };
361 
362 template<> struct gemv_dense_selector<OnTheRight,RowMajor,false>
363 {
364  template<typename Lhs, typename Rhs, typename Dest>
365  static void run(const Lhs &lhs, const Rhs &rhs, Dest& dest, const typename Dest::Scalar& alpha)
366  {
367  EIGEN_STATIC_ASSERT((!nested_eval<Lhs,1>::Evaluate),EIGEN_INTERNAL_COMPILATION_ERROR_OR_YOU_MADE_A_PROGRAMMING_MISTAKE);
368  typename nested_eval<Rhs,Lhs::RowsAtCompileTime>::type actual_rhs(rhs);
369  const Index rows = dest.rows();
370  for(Index i=0; i<rows; ++i)
371  dest.coeffRef(i) += alpha * (lhs.row(i).cwiseProduct(actual_rhs.transpose())).sum();
372  }
373 };
374 
375 } // end namespace internal
376 
377 /***************************************************************************
378 * Implementation of matrix base methods
379 ***************************************************************************/
380 
387 template<typename Derived>
388 template<typename OtherDerived>
391 {
392  // A note regarding the function declaration: In MSVC, this function will sometimes
393  // not be inlined since DenseStorage is an unwindable object for dynamic
394  // matrices and product types are holding a member to store the result.
395  // Thus it does not help tagging this function with EIGEN_STRONG_INLINE.
396  enum {
397  ProductIsValid = Derived::ColsAtCompileTime==Dynamic
398  || OtherDerived::RowsAtCompileTime==Dynamic
399  || int(Derived::ColsAtCompileTime)==int(OtherDerived::RowsAtCompileTime),
400  AreVectors = Derived::IsVectorAtCompileTime && OtherDerived::IsVectorAtCompileTime,
401  SameSizes = EIGEN_PREDICATE_SAME_MATRIX_SIZE(Derived,OtherDerived)
402  };
403  // note to the lost user:
404  // * for a dot product use: v1.dot(v2)
405  // * for a coeff-wise product use: v1.cwiseProduct(v2)
406  EIGEN_STATIC_ASSERT(ProductIsValid || !(AreVectors && SameSizes),
407  INVALID_VECTOR_VECTOR_PRODUCT__IF_YOU_WANTED_A_DOT_OR_COEFF_WISE_PRODUCT_YOU_MUST_USE_THE_EXPLICIT_FUNCTIONS)
408  EIGEN_STATIC_ASSERT(ProductIsValid || !(SameSizes && !AreVectors),
409  INVALID_MATRIX_PRODUCT__IF_YOU_WANTED_A_COEFF_WISE_PRODUCT_YOU_MUST_USE_THE_EXPLICIT_FUNCTION)
410  EIGEN_STATIC_ASSERT(ProductIsValid || SameSizes, INVALID_MATRIX_PRODUCT)
411 #ifdef EIGEN_DEBUG_PRODUCT
413 #endif
414 
415  return Product<Derived, OtherDerived>(derived(), other.derived());
416 }
417 
429 template<typename Derived>
430 template<typename OtherDerived>
433 {
434  enum {
435  ProductIsValid = Derived::ColsAtCompileTime==Dynamic
436  || OtherDerived::RowsAtCompileTime==Dynamic
437  || int(Derived::ColsAtCompileTime)==int(OtherDerived::RowsAtCompileTime),
438  AreVectors = Derived::IsVectorAtCompileTime && OtherDerived::IsVectorAtCompileTime,
439  SameSizes = EIGEN_PREDICATE_SAME_MATRIX_SIZE(Derived,OtherDerived)
440  };
441  // note to the lost user:
442  // * for a dot product use: v1.dot(v2)
443  // * for a coeff-wise product use: v1.cwiseProduct(v2)
444  EIGEN_STATIC_ASSERT(ProductIsValid || !(AreVectors && SameSizes),
445  INVALID_VECTOR_VECTOR_PRODUCT__IF_YOU_WANTED_A_DOT_OR_COEFF_WISE_PRODUCT_YOU_MUST_USE_THE_EXPLICIT_FUNCTIONS)
446  EIGEN_STATIC_ASSERT(ProductIsValid || !(SameSizes && !AreVectors),
447  INVALID_MATRIX_PRODUCT__IF_YOU_WANTED_A_COEFF_WISE_PRODUCT_YOU_MUST_USE_THE_EXPLICIT_FUNCTION)
448  EIGEN_STATIC_ASSERT(ProductIsValid || SameSizes, INVALID_MATRIX_PRODUCT)
449 
450  return Product<Derived,OtherDerived,LazyProduct>(derived(), other.derived());
451 }
452 
453 } // end namespace Eigen
454 
455 #endif // EIGEN_PRODUCT_H
SCALAR Scalar
Definition: bench_gemm.cpp:33
#define EIGEN_STRONG_INLINE
Definition: Macros.h:494
Matrix< RealScalar, Dynamic, Dynamic > M
Definition: bench_gemm.cpp:38
#define EIGEN_MAX_ALIGN_BYTES
Definition: Macros.h:775
Expression of the product of two arbitrary matrices or vectors.
Definition: Product.h:71
return int(ret)+1
EIGEN_DEVICE_FUNC Index cols() const
Definition: Diagonal.h:88
EIGEN_DEVICE_FUNC const Product< Derived, OtherDerived > operator*(const MatrixBase< OtherDerived > &other) const
#define EIGEN_DEBUG_VAR(x)
Definition: Macros.h:475
#define EIGEN_CACHEFRIENDLY_PRODUCT_THRESHOLD
A matrix or vector expression mapping an existing array of data.
Definition: Map.h:94
Expression of the transpose of a matrix.
Definition: Transpose.h:52
static EIGEN_DEVICE_FUNC EIGEN_STRONG_INLINE To run(const From &x)
Definition: BlasUtil.h:127
static void run(const Lhs &lhs, const Rhs &rhs, Dest &dest, const typename Dest::Scalar &alpha)
remove_all< Lhs >::type _Lhs
Namespace containing all symbols from the Eigen library.
Definition: jet.h:637
Holds information about the various numeric (i.e. scalar) types allowed by Eigen. ...
Definition: NumTraits.h:150
EIGEN_DEVICE_FUNC ScalarWithConstIfNotLvalue * data()
Definition: Diagonal.h:109
#define EIGEN_STATIC_ASSERT(CONDITION, MSG)
Definition: StaticAssert.h:124
#define N
Definition: gksort.c:12
#define EIGEN_SIZE_MIN_PREFER_FIXED(a, b)
Definition: Macros.h:889
std::size_t UIntPtr
Definition: Meta.h:51
virtual EIGEN_DEVICE_FUNC const Scalar coeff(DenseIndex index) const
Definition: TensorRef.h:63
Scalar Scalar int size
Definition: benchVecAdd.cpp:17
internal::plain_array< Scalar, EIGEN_SIZE_MIN_PREFER_FIXED(Size, MaxSize)+(ForceAlignment?EIGEN_MAX_ALIGN_BYTES:0), 0 > m_data
EIGEN_DEVICE_FUNC Index outerStride() const
Definition: Diagonal.h:97
remove_all< Rhs >::type _Rhs
EIGEN_DEFAULT_DENSE_INDEX_TYPE Index
The Index type as used for the API.
Definition: Meta.h:33
static void run(const Lhs &lhs, const Rhs &rhs, Dest &dest, const typename Dest::Scalar &alpha)
int data[]
EIGEN_DEVICE_FUNC const Product< Derived, OtherDerived, LazyProduct > lazyProduct(const MatrixBase< OtherDerived > &other) const
RealScalar alpha
static bool debug
NumTraits< Scalar >::Real RealScalar
Definition: bench_gemm.cpp:34
#define ei_declare_aligned_stack_constructed_variable(TYPE, NAME, SIZE, BUFFER)
Definition: Memory.h:644
static const int Cols
EIGEN_DEVICE_FUNC Index rows() const
Definition: Diagonal.h:81
static void run(const Lhs &lhs, const Rhs &rhs, Dest &dest, const typename Dest::Scalar &alpha)
#define EIGEN_PREDICATE_SAME_MATRIX_SIZE(TYPE0, TYPE1)
Definition: StaticAssert.h:171
DenseIndex ret
Definition: level1_impl.h:59
#define EIGEN_PLAIN_ENUM_MIN(a, b)
Definition: Macros.h:875
EIGEN_DEVICE_FUNC const ImagReturnType imag() const
Expression of a diagonal/subdiagonal/superdiagonal in a matrix.
Definition: Diagonal.h:63
static void run(const Lhs &lhs, const Rhs &rhs, Dest &dest, const typename Dest::Scalar &alpha)
const int Dynamic
Definition: Constants.h:21
#define eigen_internal_assert(x)
Definition: Macros.h:585
static void run(const Lhs &lhs, const Rhs &rhs, Dest &dest, const typename Dest::Scalar &alpha)
void run(Expr &expr, Dev &dev)
Definition: TensorSyclRun.h:33
product_type_selector< rows_select, cols_select, depth_select > selector
Base class for all dense matrices, vectors, and expressions.
Definition: MatrixBase.h:48
v setZero(3)


gtsam
Author(s):
autogenerated on Sat May 8 2021 02:42:07