/external/eigen/test/eigen2/ |
eigen2_geometry.cpp | 21 typedef Matrix<Scalar,2,2> Matrix2; 22 typedef Matrix<Scalar,3,3> Matrix3; 23 typedef Matrix<Scalar,4,4> Matrix4; 24 typedef Matrix<Scalar,2,1> Vector2; 25 typedef Matrix<Scalar,3,1> Vector3; 26 typedef Matrix<Scalar,4,1> Vector4; 90 // rotation matrix conversion 141 VERIFY_IS_APPROX(t0.matrix(), Transform3::MatrixType::Identity()); 142 t0.matrix().setZero(); 144 VERIFY_IS_APPROX(t0.matrix(), Transform3::MatrixType::Identity()) [all...] |
eigen2_geometry_with_eigen2_prefix.cpp | 23 typedef Matrix<Scalar,2,2> Matrix2; 24 typedef Matrix<Scalar,3,3> Matrix3; 25 typedef Matrix<Scalar,4,4> Matrix4; 26 typedef Matrix<Scalar,2,1> Vector2; 27 typedef Matrix<Scalar,3,1> Vector3; 28 typedef Matrix<Scalar,4,1> Vector4; 92 // rotation matrix conversion 143 VERIFY_IS_APPROX(t0.matrix(), Transform3::MatrixType::Identity()); 144 t0.matrix().setZero(); 146 VERIFY_IS_APPROX(t0.matrix(), Transform3::MatrixType::Identity()) [all...] |
gsl_helper.h | 26 typedef gsl_matrix* Matrix; 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& m, const Matrix& _b, Vector& eval, Matrix& evec [all...] |
/frameworks/base/core/java/android/gesture/ |
OrientedBoundingBox.java | 19 import android.graphics.Matrix; 60 Matrix matrix = new Matrix(); local 61 matrix.setRotate(orientation); 62 matrix.postTranslate(centerX, centerY); 63 matrix.mapPoints(point); 68 matrix.mapPoints(point); 73 matrix.mapPoints(point); 78 matrix.mapPoints(point) [all...] |
/packages/apps/Gallery/src/com/android/camera/ |
RotateBitmap.java | 20 import android.graphics.Matrix; 53 public Matrix getRotateMatrix() { 54 // By default this is an identity matrix. 55 Matrix matrix = new Matrix(); local 62 matrix.preTranslate(-cx, -cy); 63 matrix.postRotate(mRotation); 64 matrix.postTranslate(getWidth() / 2, getHeight() / 2); 66 return matrix; [all...] |
/external/chromium_org/third_party/skia/src/gpu/effects/ |
GrSimpleTextureEffect.h | 19 * can have a matrix applied in the VS in both the local and position cases but not with a custom 27 const SkMatrix& matrix, 30 AutoEffectUnref effect(SkNEW_ARGS(GrSimpleTextureEffect, (tex, matrix, GrTextureParams::kNone_FilterMode, coordsType))); 36 const SkMatrix& matrix, 41 SkNEW_ARGS(GrSimpleTextureEffect, (tex, matrix, filterMode, coordsType))); 46 const SkMatrix& matrix, 50 AutoEffectUnref effect(SkNEW_ARGS(GrSimpleTextureEffect, (tex, matrix, p, coordsType))); 55 the source of the coords. No matrix is allowed in this mode. */ 76 const SkMatrix& matrix, 79 : GrSingleTextureEffect(texture, matrix, filterMode, coordsType) [all...] |
/external/eigen/bench/btl/generic_bench/ |
bench_parameter.hh | 33 // min matrix size for matrix vector product bench 35 // max matrix size for matrix vector product bench 37 // min matrix size for matrix matrix product bench 39 // max matrix size for matrix matrix product benc [all...] |
/external/skia/src/gpu/effects/ |
GrSimpleTextureEffect.h | 19 * can have a matrix applied in the VS in both the local and position cases but not with a custom 27 const SkMatrix& matrix, 30 AutoEffectUnref effect(SkNEW_ARGS(GrSimpleTextureEffect, (tex, matrix, GrTextureParams::kNone_FilterMode, coordsType))); 36 const SkMatrix& matrix, 41 SkNEW_ARGS(GrSimpleTextureEffect, (tex, matrix, filterMode, coordsType))); 46 const SkMatrix& matrix, 50 AutoEffectUnref effect(SkNEW_ARGS(GrSimpleTextureEffect, (tex, matrix, p, coordsType))); 55 the source of the coords. No matrix is allowed in this mode. */ 76 const SkMatrix& matrix, 79 : GrSingleTextureEffect(texture, matrix, filterMode, coordsType) [all...] |
/frameworks/native/include/ui/ |
TMatHelpers.h | 46 * Matrix utilities 49 namespace matrix { namespace in namespace:android 59 template<typename MATRIX> 60 MATRIX PURE inverse(const MATRIX& src) { 62 COMPILE_TIME_ASSERT_FUNCTION_SCOPE( MATRIX::COL_SIZE == MATRIX::ROW_SIZE ); 64 typename MATRIX::value_type t; 65 const size_t N = MATRIX::col_size(); 67 MATRIX tmp(src) [all...] |
/external/eigen/Eigen/src/Core/ |
Matrix.h | 16 /** \class Matrix 19 * \brief The matrix class, also used for vectors and row-vectors 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> [all...] |
/external/eigen/Eigen/src/Eigen2Support/Geometry/ |
RotationBase.h | 15 // in 2D and 3D space excepted Matrix and Quaternion. 32 /** corresponding linear transformation matrix type */ 33 typedef Matrix<Scalar,Dim,Dim> RotationMatrixType; 38 /** \returns an equivalent rotation matrix */ 59 * Constructs a Dim x Dim rotation matrix from the rotation \a r 63 Matrix<_Scalar, _Rows, _Cols, _Storage, _MaxRows, _MaxCols> 64 ::Matrix(const RotationBase<OtherDerived,ColsAtCompileTime>& r) 66 EIGEN_STATIC_ASSERT_MATRIX_SPECIFIC_SIZE(Matrix,int(OtherDerived::Dim),int(OtherDerived::Dim)) 72 * Set a Dim x Dim rotation matrix from the rotation \a r 76 Matrix<_Scalar, _Rows, _Cols, _Storage, _MaxRows, _MaxCols> [all...] |
/cts/suite/cts/deviceTests/opengl/jni/graphics/ |
MeshNode.h | 17 #include "Matrix.h" 27 virtual void before(Program& program, Matrix& model, Matrix& view, Matrix& projection) = 0; 28 virtual void after(Program& program, Matrix& model, Matrix& view, Matrix& projection) = 0;
|
PerspectiveMeshNode.h | 18 #include "Matrix.h" 28 virtual void before(Program& program, Matrix& model, Matrix& view, Matrix& projection); 29 virtual void after(Program& program, Matrix& model, Matrix& view, Matrix& projection);
|
PerspectiveProgram.h | 17 #include "Matrix.h" 28 virtual void before(Matrix& model, Matrix& view, Matrix& projection); 30 Matrix mMVMatrix; 31 Matrix mMVPMatrix; 32 Matrix mLightModelMatrix;
|
TexturedMeshNode.h | 18 #include "Matrix.h" 28 virtual void before(Program& program, Matrix& model, Matrix& view, Matrix& projection); 29 virtual void after(Program& program, Matrix& model, Matrix& view, Matrix& projection);
|
Matrix.cpp | 15 #include "Matrix.h" 23 Matrix::Matrix() { 27 Matrix::Matrix(const Matrix& src) { 31 void Matrix::print(const char* label) { 39 bool Matrix::equals(const Matrix& src) { 50 void Matrix::loadWith(const Matrix& src) [all...] |
/cts/suite/cts/deviceTests/opengl/jni/reference/scene/ |
Scene.h | 17 #include <graphics/Matrix.h> 37 virtual Matrix* setUpModelMatrix() = 0; 38 virtual Matrix* setUpViewMatrix() = 0; 39 virtual Matrix* setUpProjectionMatrix(float width, float height) = 0; 47 Matrix* mModelMatrix; 48 Matrix* mViewMatrix; 49 Matrix* mProjectionMatrix;
|
/cts/suite/cts/deviceTests/opengl/jni/reference/scene/flocking/ |
WaterMeshNode.h | 18 #include <graphics/Matrix.h> 28 virtual void before(Program& program, Matrix& model, Matrix& view, Matrix& projection); 29 virtual void after(Program& program, Matrix& model, Matrix& view, Matrix& projection);
|
/cts/suite/cts/deviceTests/opengl/jni/reference/scene/glowing/ |
BlurMeshNode.h | 18 #include <graphics/Matrix.h> 28 virtual void before(Program& program, Matrix& model, Matrix& view, Matrix& projection); 29 virtual void after(Program& program, Matrix& model, Matrix& view, Matrix& projection);
|
/external/eigen/test/ |
corners.cpp | 13 VERIFY_IS_EQUAL(matrix.A, matrix.B); \ 25 MatrixType matrix = MatrixType::Random(rows,cols); local 48 MatrixType matrix = MatrixType::Random(); local 60 VERIFY_IS_EQUAL((matrix.template topLeftCorner<r,c>()), (matrix.template block<r,c>(0,0))); 61 VERIFY_IS_EQUAL((matrix.template topRightCorner<r,c>()), (matrix.template block<r,c>(0,cols-c))); 62 VERIFY_IS_EQUAL((matrix.template bottomLeftCorner<r,c>()), (matrix.template block<r,c>(rows-r,0))) [all...] |
/external/chromium_org/third_party/mesa/src/src/gallium/state_trackers/vega/ |
arc.h | 33 struct matrix; 64 struct matrix *matrix); 69 struct matrix *matrix); 73 struct matrix *matrix); 77 struct matrix *matrix);
|
/external/mesa3d/src/gallium/state_trackers/vega/ |
arc.h | 33 struct matrix; 64 struct matrix *matrix); 69 struct matrix *matrix); 73 struct matrix *matrix); 77 struct matrix *matrix);
|
/external/chromium-trace/trace-viewer/src/base/ |
gl_matrix.js | 7 base.requireRawScript('../third_party/gl-matrix/src/gl-matrix/common.js'); 8 base.requireRawScript('../third_party/gl-matrix/src/gl-matrix/mat2d.js'); 9 base.requireRawScript('../third_party/gl-matrix/src/gl-matrix/mat4.js'); 10 base.requireRawScript('../third_party/gl-matrix/src/gl-matrix/vec2.js'); 11 base.requireRawScript('../third_party/gl-matrix/src/gl-matrix/vec3.js') [all...] |
/external/eigen/Eigen/src/Eigenvalues/ |
ComplexEigenSolver.h | 26 * \tparam _MatrixType the type of the matrix of which we are 28 * instantiation of the Matrix class template. 30 * The eigenvalues and eigenvectors of a matrix \f$ A \f$ are scalars 32 * \f$. If \f$ D \f$ is a diagonal matrix with the eigenvalues on 33 * the diagonal, and \f$ V \f$ is a matrix with the eigenvectors as 34 * its columns, then \f$ A V = V D \f$. The matrix \f$ V \f$ is 78 typedef Matrix<ComplexScalar, ColsAtCompileTime, 1, Options&(~RowMajor), MaxColsAtCompileTime, 1> EigenvalueType; 80 /** \brief Type for matrix of eigenvectors as returned by eigenvectors(). 82 * This is a square matrix with entries of type #ComplexScalar. 85 typedef Matrix<ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompi (…) [all...] |
/external/eigen/doc/examples/ |
TutorialLinAlgRankRevealing.cpp | 13 cout << "Here is the matrix A:\n" << A << endl; 16 cout << "Here is a matrix whose columns form a basis of the null-space of A:\n" 18 cout << "Here is a matrix whose columns form a basis of the column-space of A:\n"
|