Searched defs:Matrix (Results 1 - 25 of 46) sorted by path

12

/external/ceres-solver/examples/
H A Dnist.cc124 typedef Eigen::Matrix<double, Dynamic, 1> Vector;
125 typedef Eigen::Matrix<double, Dynamic, Dynamic, RowMajor> Matrix; typedef in namespace:ceres::examples
231 Matrix initial_parameters(int start) const { return initial_parameters_.row(start); }
232 Matrix final_parameters() const { return final_parameters_; }
233 Matrix predictor() const { return predictor_; }
234 Matrix response() const { return response_; }
243 Matrix predictor_;
244 Matrix response_;
245 Matrix initial_parameters
[all...]
/external/ceres-solver/include/ceres/internal/
H A Deigen.h38 typedef Eigen::Matrix<double, Eigen::Dynamic, 1> Vector;
39 typedef Eigen::Matrix<double,
42 Eigen::RowMajor> Matrix; typedef in namespace:ceres
44 typedef Eigen::Map<Matrix> MatrixRef;
46 typedef Eigen::Map<const Matrix> ConstMatrixRef;
49 typedef Eigen::Matrix<double,
64 // struct so that we can support statically sized Matrix and Maps.
67 typedef Eigen::Matrix <double, num_rows, num_cols, Eigen::RowMajor>
68 Matrix; typedef in struct:ceres::EigenTypes
71 Eigen::Matrix<doubl
[all...]
/external/chromium_org/third_party/WebKit/Source/platform/transforms/
H A DTransformOperation.h45 Matrix, enumerator in enum:blink::TransformOperation::OperationType
/external/chromium_org/third_party/android_platform/webview/
H A Dframeworks.jarMETA-INF/ META-INF/MANIFEST.MF android/ android/location/ android/location/Address$1.class ...
/external/chromium_org/third_party/libaddressinput/src/java/
H A Dandroid.jarMETA-INF/ META-INF/MANIFEST.MF AndroidManifest.xml android/ android/Manifest$permission.class ...
/external/chromium_org/third_party/skia/experimental/PdfViewer/pdfparser/native/pdfapi/
H A DSkPdfCalrgbColorSpaceDictionary_autogen.cpp47 SkPdfArray* SkPdfCalrgbColorSpaceDictionary::Matrix(SkPdfNativeDoc* doc) { function in class:SkPdfCalrgbColorSpaceDictionary
48 SkPdfNativeObject* ret = get("Matrix", "");
56 return get("Matrix", "") != NULL;
H A DSkPdfType1FormDictionary_autogen.cpp83 SkMatrix SkPdfType1FormDictionary::Matrix(SkPdfNativeDoc* doc) { function in class:SkPdfType1FormDictionary
84 SkPdfNativeObject* ret = get("Matrix", "");
92 return get("Matrix", "") != NULL;
H A DSkPdfType1PatternDictionary_autogen.cpp107 SkMatrix SkPdfType1PatternDictionary::Matrix(SkPdfNativeDoc* doc) { function in class:SkPdfType1PatternDictionary
108 SkPdfNativeObject* ret = get("Matrix", "");
116 return get("Matrix", "") != NULL;
H A DSkPdfType1ShadingDictionary_autogen.cpp23 SkPdfArray* SkPdfType1ShadingDictionary::Matrix(SkPdfNativeDoc* doc) { function in class:SkPdfType1ShadingDictionary
24 SkPdfNativeObject* ret = get("Matrix", "");
32 return get("Matrix", "") != NULL;
H A DSkPdfType2PatternDictionary_autogen.cpp67 SkPdfArray* SkPdfType2PatternDictionary::Matrix(SkPdfNativeDoc* doc) { function in class:SkPdfType2PatternDictionary
68 SkPdfNativeObject* ret = get("Matrix", "");
76 return get("Matrix", "") != NULL;
/external/chromium_org/third_party/skia/src/sfnt/
H A DSkOTTable_glyf.h157 union Matrix { union in union:SkOTTableGlyphData::Composite::Component::Transform
181 SkOTTableGlyphData::Composite::Component::Transform::Matrix matrix;
187 SkOTTableGlyphData::Composite::Component::Transform::Matrix matrix;
193 SkOTTableGlyphData::Composite::Component::Transform::Matrix matrix;
199 SkOTTableGlyphData::Composite::Component::Transform::Matrix matrix;
/external/clang/test/Sema/
H A Darray-init.c254 typedef struct _Matrix Matrix; typedef in typeref:struct:_Matrix
256 const Matrix mat1 = {
263 const Matrix mat2 = {
/external/deqp/framework/common/
H A DtcuMatrix.hpp51 class Matrix class in namespace:tcu
64 Matrix (void);
65 explicit Matrix (const T& src);
66 explicit Matrix (const T src[Rows*Cols]);
67 Matrix (const Vector<T, Rows>& src);
68 Matrix (const Matrix<T, Rows, Cols>& src);
69 ~Matrix (void);
71 Matrix<T, Rows, Cols>& operator= (const Matrix<
142 determinant(const Matrix<T, Size, Size>& mat) argument
148 inverse(const Matrix<T, Size, Size>& mat) argument
158 doDeterminant(const Matrix<T, 2, 2>& mat) argument
164 doDeterminant(const Matrix<T, 3, 3>& mat) argument
175 doDeterminant(const Matrix<T, 4, 4>& mat) argument
210 doInverse(const Matrix<T, 2, 2>& mat) argument
226 doInverse(const Matrix<T, 3, 3>& mat) argument
275 doInverse(const Matrix<T, 4, 4>& mat) argument
328 Matrix<T, Rows, Cols>::Matrix (void) function in class:tcu::Matrix
337 Matrix<T, Rows, Cols>::Matrix (const T& src) function in class:tcu::Matrix
346 Matrix<T, Rows, Cols>::Matrix (const T src[Rows*Cols]) function in class:tcu::Matrix
355 Matrix<T, Rows, Cols>::Matrix (const Vector<T, Rows>& src) function in class:tcu::Matrix
365 Matrix(const Matrix<T, Rows, Cols>& src) argument
378 operator =(const Matrix<T, Rows, Cols>& src) argument
388 operator *=(const Matrix<T, Rows, Cols>& src) argument
452 operator *(const Matrix<T, Rows0, Cols0>& a, const Matrix<T, Rows1, Cols1>& b) argument
471 operator *(const Matrix<T, Rows, Cols>& mtx, const Vector<T, Cols>& vec) argument
486 operator *(const Vector<T, Rows>& vec, const Matrix<T, Rows, Cols>& mtx) argument
521 operator +(const Matrix<T, Rows, Cols>& mtx, T scalar) argument
531 operator -(const Matrix<T, Rows, Cols>& mtx, T scalar) argument
541 operator *(const Matrix<T, Rows, Cols>& mtx, T scalar) argument
551 operator /(const Matrix<T, Rows, Cols>& mtx, T scalar) argument
563 operator +(const Matrix<T, Rows, Cols>& a, const Matrix<T, Rows, Cols>& b) argument
573 operator -(const Matrix<T, Rows, Cols>& a, const Matrix<T, Rows, Cols>& b) argument
583 operator /(const Matrix<T, Rows, Cols>& a, const Matrix<T, Rows, Cols>& b) argument
[all...]
/external/deqp/modules/glshared/
H A DglsBuiltinPrecisionTests.cpp89 using tcu::Matrix;
472 struct Traits<Matrix<T, Rows, Cols> > :
473 ContainerTraits<Matrix<T, Rows, Cols>, Matrix<typename Traits<T>::IVal, Rows, Cols> >
901 class ExprP<Matrix<T, Rows, Cols> > : public ContainerExprPBase<Matrix<T, Rows, Cols> > {};
972 ExprP<Matrix<float, Left, Right> > operator* (const ExprP<Matrix<float, Left, Mid> >& left,
973 const ExprP<Matrix<float, Mid, Right> >& right);
976 const ExprP<Matrix<floa
4607 operator ()(const Matrix<T, Rows, Cols>& mat1, const Matrix<T, Rows, Cols>& mat2) const argument
[all...]
/external/eigen/Eigen/src/Core/
H A DMap.h184 inline Matrix<_Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols>
185 ::Matrix(const Scalar *data) function in class:Eigen::Matrix
187 this->_set_noalias(Eigen::Map<const Matrix>(data));
H A DMatrix.h16 /** \class Matrix
21 * The %Matrix class is the work-horse for all \em dense (\ref dense "note") matrices and vectors within Eigen.
24 * The %Matrix class encompasses \em both fixed-size and dynamic-size objects (\ref fixedsize "note").
42 * \li \c Matrix2d is a 2x2 square matrix of doubles (\c Matrix<double, 2, 2>)
43 * \li \c Vector4f is a vector of 4 floats (\c Matrix<float, 4, 1>)
44 * \li \c RowVector3i is a row-vector of 3 ints (\c Matrix<int, 1, 3>)
46 * \li \c MatrixXf is a dynamic-size matrix of floats (\c Matrix<float, Dynamic, Dynamic>)
47 * \li \c VectorXf is a dynamic-size vector of floats (\c Matrix<float, Dynamic, 1>)
49 * \li \c Matrix2Xf is a partially fixed-size (dynamic-size) matrix of floats (\c Matrix<float, 2, Dynamic>)
50 * \li \c MatrixX3d is a partially dynamic-size (fixed-size) matrix of double (\c Matrix<doubl
127 class Matrix class in namespace:Eigen
203 EIGEN_STRONG_INLINE Matrix() : Base() function in class:Eigen::Matrix
210 Matrix(internal::constructor_without_unaligned_array_assert) function in class:Eigen::Matrix
220 EIGEN_STRONG_INLINE explicit Matrix(Index dim) function in class:Eigen::Matrix
232 EIGEN_STRONG_INLINE Matrix(const T0& x, const T1& y) function in class:Eigen::Matrix
249 EIGEN_STRONG_INLINE Matrix(const Scalar& x, const Scalar& y, const Scalar& z) function in class:Eigen::Matrix
258 EIGEN_STRONG_INLINE Matrix(const Scalar& x, const Scalar& y, const Scalar& z, const Scalar& w) function in class:Eigen::Matrix
272 EIGEN_STRONG_INLINE Matrix(const MatrixBase<OtherDerived>& other) function in class:Eigen::Matrix
284 EIGEN_STRONG_INLINE Matrix(const Matrix& other) function in class:Eigen::Matrix
292 EIGEN_STRONG_INLINE Matrix(const ReturnByValue<OtherDerived>& other) function in class:Eigen::Matrix
303 EIGEN_STRONG_INLINE Matrix(const EigenBase<OtherDerived> &other) function in class:Eigen::Matrix
[all...]
/external/eigen/Eigen/src/Eigen2Support/Geometry/
H A DRotationBase.h15 // in 2D and 3D space excepted Matrix and Quaternion.
33 typedef Matrix<Scalar,Dim,Dim> RotationMatrixType;
63 Matrix<_Scalar, _Rows, _Cols, _Storage, _MaxRows, _MaxCols>
64 ::Matrix(const RotationBase<OtherDerived,ColsAtCompileTime>& r) function in class:Eigen::Matrix
66 EIGEN_STATIC_ASSERT_MATRIX_SPECIFIC_SIZE(Matrix,int(OtherDerived::Dim),int(OtherDerived::Dim))
76 Matrix<_Scalar, _Rows, _Cols, _Storage, _MaxRows, _MaxCols>&
77 Matrix<_Scalar, _Rows, _Cols, _Storage, _MaxRows, _MaxCols>
80 EIGEN_STATIC_ASSERT_MATRIX_SPECIFIC_SIZE(Matrix,int(OtherDerived::Dim),int(OtherDerived::Dim))
103 static inline Matrix<Scalar,2,2> ei_toRotationMatrix(const Scalar& s)
110 static inline Matrix<Scala
[all...]
/external/eigen/Eigen/src/Geometry/
H A DRotationBase.h37 typedef Matrix<Scalar,Dim,Dim> RotationMatrixType;
38 typedef Matrix<Scalar,Dim,1> VectorType;
104 typedef Matrix<typename RotationDerived::Scalar,Dim,Dim> ReturnType;
125 typedef Matrix<typename RotationDerived::Scalar,Dim,1> ReturnType;
140 Matrix<_Scalar, _Rows, _Cols, _Storage, _MaxRows, _MaxCols>
141 ::Matrix(const RotationBase<OtherDerived,ColsAtCompileTime>& r) function in class:Eigen::Matrix
143 EIGEN_STATIC_ASSERT_MATRIX_SPECIFIC_SIZE(Matrix,int(OtherDerived::Dim),int(OtherDerived::Dim))
153 Matrix<_Scalar, _Rows, _Cols, _Storage, _MaxRows, _MaxCols>&
154 Matrix<_Scalar, _Rows, _Cols, _Storage, _MaxRows, _MaxCols>
157 EIGEN_STATIC_ASSERT_MATRIX_SPECIFIC_SIZE(Matrix,in
[all...]
/external/eigen/bench/spbench/
H A Dspbenchsolver.h214 void call_solver(Solver &solver, const int solver_id, const typename Solver::MatrixType& A, const Matrix<Scalar, Dynamic, 1>& b, const Matrix<Scalar, Dynamic, 1>& refX,std::ofstream& statbuf) argument
221 Matrix<Scalar, Dynamic, 1> x;
261 Matrix<Scalar, Dynamic, 1> temp;
279 void call_directsolver(Solver& solver, const int solver_id, const typename Solver::MatrixType& A, const Matrix<Scalar, Dynamic, 1>& b, const Matrix<Scalar, Dynamic, 1>& refX, std::string& statFile) argument
289 void call_itersolver(Solver &solver, const int solver_id, const typename Solver::MatrixType& A, const Matrix<Scalar, Dynamic, 1>& b, const Matrix<Scalar, Dynamic, 1>& refX, std::string& statFile) argument
305 void SelectSolvers(const SparseMatrix<Scalar>&A, unsigned int sym, Matrix<Scalar, Dynamic, 1>& b, const Matrix<Scala argument
[all...]
/external/eigen/demos/opengl/
H A Dgpuhelper.h38 \sa Matrix, loadMatrix(), forceMatrixMode()
41 void multMatrix(const Matrix<Scalar,4,4, _Flags, 4,4>& mat, GLenum matrixTarget);
48 \sa Matrix, multMatrix(), forceMatrixMode()
51 void loadMatrix(const Eigen::Matrix<Scalar,4,4, _Flags, 4,4>& mat, GLenum matrixTarget);
70 inline void pushMatrix(const Matrix<Scalar,4,4, _Flags, 4,4>& mat, GLenum matrixTarget);
120 static void loadMatrix(const Matrix<float, 4,4, _Flags, 4,4>& mat) { glLoadMatrixf(mat.data()); } argument
121 static void loadMatrix(const Matrix<double,4,4, _Flags, 4,4>& mat) { glLoadMatrixd(mat.data()); } argument
122 static void multMatrix(const Matrix<float, 4,4, _Flags, 4,4>& mat) { glMultMatrixf(mat.data()); } argument
123 static void multMatrix(const Matrix<double,4,4, _Flags, 4,4>& mat) { glMultMatrixd(mat.data()); } argument
128 static void loadMatrix(const Matrix<floa argument
129 loadMatrix(const Matrix<double,4,4, _Flags, 4,4>& mat) argument
130 multMatrix(const Matrix<float, 4,4, _Flags, 4,4>& mat) argument
131 multMatrix(const Matrix<double,4,4, _Flags, 4,4>& mat) argument
141 multMatrix(const Matrix<Scalar,4,4, _Flags, 4,4>& mat, GLenum matrixTarget) argument
170 pushMatrix(const Matrix<Scalar,4,4, _Flags, 4,4>& mat, GLenum matrixTarget) argument
[all...]
/external/eigen/test/eigen2/
H A Dgsl_helper.h26 typedef gsl_matrix* Matrix; typedef in struct:Eigen::GslTraits
28 static Matrix createMatrix(int rows, int cols) { return gsl_matrix_alloc(rows,cols); }
30 static void free(Matrix& m) { gsl_matrix_free(m); m=0; }
32 static void prod(const Matrix& m, const Vector& v, Vector& x) { gsl_blas_dgemv(CblasNoTrans,1,m,v,0,x); }
33 static void cholesky(Matrix& m) { gsl_linalg_cholesky_decomp(m); }
34 static void cholesky_solve(const Matrix& m, const Vector& b, Vector& x) { gsl_linalg_cholesky_solve(m,b,x); }
35 static void eigen_symm(const Matrix& m, Vector& eval, Matrix& evec)
38 Matrix a = createMatrix(m->size1, m->size2);
45 static void eigen_symm_gen(const Matrix
61 typedef gsl_matrix_complex* Matrix; typedef in struct:Eigen::GslTraits
[all...]
/external/eigen/test/
H A Dgeo_eulerangles.cpp17 void verify_euler(const Matrix<Scalar,3,1>& ea, int i, int j, int k) argument
19 typedef Matrix<Scalar,3,3> Matrix3;
20 typedef Matrix<Scalar,3,1> Vector3;
41 template<typename Scalar> void check_all_var(const Matrix<Scalar,3,1>& ea) argument
61 typedef Matrix<Scalar,3,3> Matrix3;
62 typedef Matrix<Scalar,3,1> Vector3;
H A Dnomalloc.cpp107 typedef Eigen::Matrix<Scalar,
110 maxSize, maxSize> Matrix; typedef
112 typedef Eigen::Matrix<Scalar,
117 typedef Eigen::Matrix<std::complex<Scalar>,
122 const Matrix A(Matrix::Random(size, size)), B(Matrix::Random(size, size));
123 Matrix X(size,size);
125 const Matrix saA = A.adjoint() * A;
130 Eigen::LLT<Matrix> LL
[all...]
/external/eigen/unsupported/Eigen/src/LevenbergMarquardt/
H A DLMqrsolv.h24 Matrix<Scalar,Rows,Cols> &s,
26 const Matrix<Scalar,Dynamic,1> &diag,
27 const Matrix<Scalar,Dynamic,1> &qtb,
28 Matrix<Scalar,Dynamic,1> &x,
29 Matrix<Scalar,Dynamic,1> &sdiag)
36 Matrix<Scalar,Dynamic,1> wa(n);
106 const Matrix<Scalar,Dynamic,1> &diag,
107 const Matrix<Scalar,Dynamic,1> &qtb,
108 Matrix<Scalar,Dynamic,1> &x,
109 Matrix<Scala
23 lmqrsolv( Matrix<Scalar,Rows,Cols> &s, const PermutationMatrix<Dynamic,Dynamic,Index> &iPerm, const Matrix<Scalar,Dynamic,1> &diag, const Matrix<Scalar,Dynamic,1> &qtb, Matrix<Scalar,Dynamic,1> &x, Matrix<Scalar,Dynamic,1> &sdiag) argument
103 lmqrsolv( SparseMatrix<Scalar,_Options,Index> &s, const PermutationMatrix<Dynamic,Dynamic> &iPerm, const Matrix<Scalar,Dynamic,1> &diag, const Matrix<Scalar,Dynamic,1> &qtb, Matrix<Scalar,Dynamic,1> &x, Matrix<Scalar,Dynamic,1> &sdiag) argument
[all...]
/external/eigen/unsupported/Eigen/src/MatrixFunctions/
H A DMatrixPower.h261 * of the Matrix class template.
325 typedef Matrix<ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, MatrixType::Options,
343 Matrix<ComplexScalar, Rows, Cols, Options, MaxRows, MaxCols>& res,
349 Matrix<RealScalar, Rows, Cols, Options, MaxRows, MaxCols>& res,
429 Matrix<ComplexScalar, Rows, Cols, Options, MaxRows, MaxCols>& res,
437 Matrix<RealScalar, Rows, Cols, Options, MaxRows, MaxCols>& res,
466 * \param[in] A %Matrix (expression), the base of the matrix power.
428 revertSchur( Matrix<ComplexScalar, Rows, Cols, Options, MaxRows, MaxCols>& res, const ComplexMatrix& T, const ComplexMatrix& U) argument
436 revertSchur( Matrix<RealScalar, Rows, Cols, Options, MaxRows, MaxCols>& res, const ComplexMatrix& T, const ComplexMatrix& U) argument

Completed in 1193 milliseconds

12