/external/eigen/Eigen/src/SparseCore/ |
CompressedStorage.h | 36 : m_values(0), m_indices(0), m_size(0), m_allocatedSize(0) 40 : m_values(0), m_indices(0), m_size(0), m_allocatedSize(0) 46 : m_values(0), m_indices(0), m_size(0), m_allocatedSize(0) 54 internal::smart_copy(other.m_values, other.m_values + m_size, m_values); 61 std::swap(m_values, other.m_values); 69 delete[] m_values; 97 m_values[id] = v 222 Scalar* m_values; member in class:Eigen::internal::CompressedStorage [all...] |
MappedSparseMatrix.h | 45 Scalar* m_values; member in class:Eigen::MappedSparseMatrix 58 inline const Scalar* valuePtr() const { return m_values; } 59 inline Scalar* valuePtr() { return m_values; } 78 return m_values[end-1]; 84 return ((*r==inner) && (id<end)) ? m_values[id] : Scalar(0); 99 return m_values[id]; 110 m_innerIndices(innerIndexPtr), m_values(valuePtr)
|
SparseMatrix.h | 873 : m_values(mat.valuePtr()), m_indices(mat.innerIndexPtr()), m_outer(outer), m_id(mat.m_outerIndex[outer]) 883 inline const Scalar& value() const { return m_values[m_id]; } 884 inline Scalar& valueRef() { return const_cast<Scalar&>(m_values[m_id]); } 894 const Scalar* m_values; member in class:Eigen::SparseMatrix::InnerIterator 927 const Scalar* m_values; member in class:Eigen::SparseMatrix::ReverseInnerIterator [all...] |
/external/pdfium/xfa/src/fxbarcode/pdf417/ |
BC_PDF417BarcodeValue.cpp | 32 confidence = m_values.GetAt(i);
33 m_values.SetAt(i, confidence + 1);
39 m_values.Add(confidence);
45 if (m_values.GetAt(i) > maxConfidence) {
46 maxConfidence = m_values.GetAt(i);
49 } else if (m_values.GetAt(i) == maxConfidence) {
58 return m_values.GetAt(i);
|
BC_PDF417BarcodeValue.h | 19 CFX_Int32Array m_values;
member in class:CBC_BarcodeValue
|
/external/eigen/unsupported/Eigen/src/AutoDiff/ |
AutoDiffVector.h | 46 : m_values(values) 52 CoeffType operator[] (Index i) { return CoeffType(m_values[i], m_jacobian.col(i)); } 53 const CoeffType operator[] (Index i) const { return CoeffType(m_values[i], m_jacobian.col(i)); } 55 CoeffType operator() (Index i) { return CoeffType(m_values[i], m_jacobian.col(i)); } 56 const CoeffType operator() (Index i) const { return CoeffType(m_values[i], m_jacobian.col(i)); } 58 CoeffType coeffRef(Index i) { return CoeffType(m_values[i], m_jacobian.col(i)); } 59 const CoeffType coeffRef(Index i) const { return CoeffType(m_values[i], m_jacobian.col(i)); } 61 Index size() const { return m_values.size(); } 64 Scalar sum() const { /*std::cerr << "sum \n\n";*/ /*std::cerr << m_jacobian.rowwise().sum() << "\n\n";*/ return Scalar(m_values.sum(), m_jacobian.rowwise().sum()); } 68 : m_values(values), m_jacobian(jac 213 ValueType m_values; member in class:Eigen::AutoDiffVector [all...] |
/external/emma/core/java12/com/vladium/util/ |
IntVector.java | 27 m_values = new int [initCapacity]; 37 return m_values [index]; 51 for (int i = 0; i < size; ++ i) result [i] = m_values [i]; 55 System.arraycopy (m_values, 0, result, 0, size); 81 _clone.m_values = new int [m_values.length]; 82 final int [] _clone_values = _clone.m_values; 83 for (int i = 0; i < m_size; ++ i) _clone_values [i] = m_values [i]; 87 _clone.m_values = (int []) m_values.clone () 151 private int [] m_values; \/\/ never null field in class:IntVector [all...] |
/external/eclipse-windowbuilder/propertysheet/src/org/eclipse/wb/internal/core/model/property/editor/ |
EnumerationValuesPropertyEditor.java | 32 private final Object[] m_values; field in class:EnumerationValuesPropertyEditor 44 m_values = new Object[items]; 48 m_values[i] = enumElements[3 * i + 1]; 63 for (int i = 0; i < m_values.length; i++) { 64 if (Objects.equal(m_values[i], value)) { 81 for (int i = 0; i < m_values.length; i++) { 82 if (Objects.equal(m_values[i], value)) { 120 Object value = m_values[index];
|
/external/apache-xml/src/main/java/org/apache/xml/utils/ |
StringToIntTable.java | 37 * in m_values */ 42 private int m_values[]; field in class:StringToIntTable 60 m_values = new int[m_blocksize]; 74 m_values = new int[m_blocksize]; 108 System.arraycopy(m_values, 0, newValues, 0, m_firstFree + 1); 110 m_values = newValues; 114 m_values[m_firstFree] = value; 133 return m_values[i]; 155 return m_values[i];
|
BoolStack.java | 32 private boolean m_values[]; field in class:BoolStack 58 m_values = new boolean[size]; 94 return (m_values[++m_index] = val); 106 return m_values[m_index--]; 121 return (m_index >= 0) ? m_values[m_index] : false; 132 m_values[m_index] = b; 144 return m_values[m_index]; 155 return (m_index > -1) ? m_values[m_index] : false; 166 return (m_index > -1) ? m_values[m_index] : true; 191 System.arraycopy(m_values, 0, newVector, 0, m_index + 1) [all...] |
/external/apache-xml/src/main/java/org/apache/xml/serializer/utils/ |
StringToIntTable.java | 44 * in m_values */ 49 private int m_values[]; field in class:StringToIntTable 67 m_values = new int[m_blocksize]; 81 m_values = new int[m_blocksize]; 115 System.arraycopy(m_values, 0, newValues, 0, m_firstFree + 1); 117 m_values = newValues; 121 m_values[m_firstFree] = value; 140 return m_values[i]; 162 return m_values[i];
|
/external/eigen/unsupported/test/ |
NumericalDiff.cpp | 24 int m_inputs, m_values; member in struct:Functor 26 Functor() : m_inputs(InputsAtCompileTime), m_values(ValuesAtCompileTime) {} 27 Functor(int inputs, int values) : m_inputs(inputs), m_values(values) {} 30 int values() const { return m_values; }
|
forward_adolc.cpp | 37 int m_inputs, m_values; member in struct:TestFunc1 39 TestFunc1() : m_inputs(InputsAtCompileTime), m_values(ValuesAtCompileTime) {} 40 TestFunc1(int inputs, int values) : m_inputs(inputs), m_values(values) {} 43 int values() const { return m_values; }
|
autodiff.cpp | 43 int m_inputs, m_values; member in struct:TestFunc1 45 TestFunc1() : m_inputs(InputsAtCompileTime), m_values(ValuesAtCompileTime) {} 46 TestFunc1(int inputs, int values) : m_inputs(inputs), m_values(values) {} 49 int values() const { return m_values; }
|
/external/eigen/unsupported/Eigen/src/LevenbergMarquardt/ |
LevenbergMarquardt.h | 53 const int m_inputs, m_values; member in struct:Eigen::DenseFunctor 55 DenseFunctor() : m_inputs(InputsAtCompileTime), m_values(ValuesAtCompileTime) {} 56 DenseFunctor(int inputs, int values) : m_inputs(inputs), m_values(values) {} 59 int values() const { return m_values; } 82 SparseFunctor(int inputs, int values) : m_inputs(inputs), m_values(values) {} 85 int values() const { return m_values; } 87 const int m_inputs, m_values; member in struct:Eigen::SparseFunctor
|
/external/emma/core/java12/com/vladium/util/args/ |
OptsParser.java | 520 if (m_values == null) return 0; 522 return m_values.size (); 527 if (m_values == null) return null; 529 return (String) m_values.get (0); 534 if (m_values == null) return IConstants.EMPTY_STRING_ARRAY; 536 final String [] result = new String [m_values.size ()]; 537 m_values.toArray (result); 552 if (m_values != null) 555 s.append (m_values); 572 if (m_values == null) m_values = new ArrayList () 578 private ArrayList m_values; field in class:OptsParser.Opt [all...] |
/external/deqp/framework/randomshaders/ |
rsgProgramExecutor.cpp | 82 std::map<std::string, VaryingStorage*> m_values; member in class:rsg::VaryingStore 92 for (map<string, VaryingStorage*>::iterator i = m_values.begin(); i != m_values.end(); i++) 94 m_values.clear(); 99 VaryingStorage* storage = m_values[name]; 104 m_values[name] = storage;
|
/external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/CollisionShapes/ |
btStridingMeshInterface.cpp | 293 tmpIndices[gfxindex].m_values[0] = tri_indices[0]; 294 tmpIndices[gfxindex].m_values[1] = tri_indices[1]; 295 tmpIndices[gfxindex].m_values[2] = tri_indices[2]; 311 tmpIndices[gfxindex].m_values[0] = tri_indices[0]; 312 tmpIndices[gfxindex].m_values[1] = tri_indices[1]; 313 tmpIndices[gfxindex].m_values[2] = tri_indices[2];
|
btStridingMeshInterface.h | 117 short m_values[3]; member in struct:btShortIntIndexTripletData 123 unsigned char m_values[3]; member in struct:btCharIndexTripletData
|
/external/deqp/framework/common/ |
tcuTestLog.hpp | 207 SampleBuilder& operator<< (int v) { m_values.push_back(Value((deInt64)v)); return *this; } 208 SampleBuilder& operator<< (deInt64 v) { m_values.push_back(Value(v)); return *this; } 209 SampleBuilder& operator<< (float v) { m_values.push_back(Value((double)v)); return *this; } 210 SampleBuilder& operator<< (double v) { m_values.push_back(Value(v)); return *this; } 232 std::vector<Value> m_values; member in class:tcu::SampleBuilder
|
/external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/CollisionDispatch/ |
btCollisionWorldImporter.cpp | 686 indexArray[3*j] = meshData.m_meshPartsPtr[i].m_3indices16[j].m_values[0]; 687 indexArray[3*j+1] = meshData.m_meshPartsPtr[i].m_3indices16[j].m_values[1]; 688 indexArray[3*j+2] = meshData.m_meshPartsPtr[i].m_3indices16[j].m_values[2]; 717 indexArray[3*j] = meshData.m_meshPartsPtr[i].m_3indices8[j].m_values[0]; 718 indexArray[3*j+1] = meshData.m_meshPartsPtr[i].m_3indices8[j].m_values[1]; 719 indexArray[3*j+2] = meshData.m_meshPartsPtr[i].m_3indices8[j].m_values[2]; [all...] |
/external/apache-xml/src/main/java/org/apache/xml/dtm/ref/sax2dtm/ |
SAX2DTM2.java | 1802 protected Vector m_values; field in class:SAX2DTM2 [all...] |
/external/libgdx/tests/gdx-tests-android/assets/data/g3d/ |
btscene1.bullet | 46 ?#= ARAY ???? cube3_bodyShape DNA1D# ???? SDNANAME? m_size m_capacity *m_data m_collisionShapes m_collisionObjects m_constraints *first *last m_floats[4] m_el[3] m_basis m_origin m_rootNodeIndex m_subtreeSize m_quantizedAabbMin[3] m_quantizedAabbMax[3] m_aabbMinOrg m_aabbMaxOrg m_escapeIndex m_subPart m_triangleIndex m_pad[4] m_escapeIndexOrTriangleIndex m_bvhAabbMin m_bvhAabbMax m_bvhQuantization m_curNodeIndex m_useQuantization m_numContiguousLeafNodes m_numQuantizedContiguousNodes *m_contiguousNodesPtr *m_quantizedContiguousNodesPtr *m_subTreeInfoPtr m_traversalMode m_numSubtreeHeaders *m_name m_shapeType m_padding[4] m_collisionShapeData m_localScaling m_planeNormal m_planeConstant m_implicitShapeDimensions m_collisionMargin m_padding m_pos m_radius m_convexInternalShapeData *m_localPositionArrayPtr m_localPositionArraySize m_value m_pad[2] m_values[3] m_pad *m_vertices3f *m_vertices3d *m_indices32 *m_3indices16 *m_3indices8 *m_indices16 m_numTriangles m_numVertices *m_meshPartsPtr m_scaling m_numMeshParts m_meshInterface *m_quantizedFloatBvh *m_quantizedDoubleBvh *m_triangleInfoMap m_pad3[4] m_trimeshShapeData m_transform *m_childShape m_childShapeType m_childMargin *m_childShapePtr m_numChildShapes m_upAxis m_flags m_edgeV0V1Angle m_edgeV1V2Angle m_edgeV2V0Angle *m_hashTablePtr *m_nextPtr *m_valueArrayPtr *m_keyArrayPtr m_convexEpsilon m_planarEpsilon m_equalVertexThreshold m_edgeDistanceThreshold m_zeroAreaThreshold m_nextSize m_hashTableSize m_numValues m_numKeys m_gimpactSubType *m_unscaledPointsFloatPtr *m_unscaledPointsDoublePtr m_numUnscaledPoints m_padding3[4] *m_broadphaseHandle *m_collisionShape *m_rootCollisionShape m_worldTransform m_interpolationWorldTransform m_interpolationLinearVelocity m_interpolationAngularVelocity m_anisotropicFriction m_contactProcessingThreshold m_deactivationTime m_friction m_rollingFriction m_restitution m_hitFraction m_ccdSweptSphereRadius m_ccdMotionThreshold m_hasAnisotropicFriction m_collisionFlags m_islandTag1 m_companionId m_activationState1 m_internalType m_checkCollideWith m_solverInfo m_gravity m_collisionObjectData m_invInertiaTensorWorld m_linearVelocity m_angularVelocity m_angularFactor m_linearFactor m_gravity_acceleration m_invInertiaLocal m_totalForce m_totalTorque m_inverseMass m_linearDamping m_angularDamping m_additionalDampingFactor m_additionalLinearDampingThresholdSqr m_additionalAngularDampingThresholdSqr m_additionalAngularDampingFactor m_linearSleepingThreshold m_angularSleepingThreshold m_additionalDamping m_numConstraintRows nub *m_rbA *m_rbB m_objectType m_userConstraintType m_userConstraintId m_needsFeedback m_appliedImpulse m_dbgDrawSize m_disableCollisionsBetweenLinkedBodies m_overrideNumSolverIterations m_breakingImpulseThreshold m_isEnabled m_typeConstraintData m_pivotInA m_pivotInB m_rbAFrame m_rbBFrame m_useReferenceFrameA m_angularOnly m_enableAngularMotor m_motorTargetVelocity m_maxMotorImpulse m_lowerLimit m_upperLimit m_limitSoftness m_biasFactor m_relaxationFactor m_swingSpan1 m_swingSpan2 m_twistSpan m_damping m_linearUpperLimit m_linearLowerLimit m_angularUpperLimit m_angularLowerLimit m_useLinearReferenceFrameA m_useOffsetForConstraintFrame m_6dofData m_springEnabled[6] m_equilibriumPoint[6] m_springStiffness[6] m_springDamping[6] m_tau m_timeStep m_maxErrorReduction m_sor m_erp m_erp2 m_globalCfm m_splitImpulsePenetrationThreshold m_splitImpulseTurnErp m_linearSlop m_warmstartingFactor m_maxGyroscopicForce m_singleAxisRollingFrictionThreshold m_numIterations m_solverMode m_restingContactRestitutionThreshold m_minimumSolverBatchSize m_splitImpulse m_linearStiffness m_angularStiffness m_volumeStiffness *m_material m_position m_previousPosition m_velocity m_accumulatedForce m_normal m_area m_attach m_nodeIndices[2] m_restLength m_bbending m_nodeIndices[3] m_restArea m_c0[4] m_nodeIndices[4] m_restVolume m_c1 m_c2 m_c0 m_localFrame *m_rigidBody m_nodeIndex m_aeroModel m_baumgarte m_drag m_lift m_pressure m_volume m_dynamicFriction m_poseMatch m_rigidContactHardness m_kineticContactHardness m_softContactHardness m_anchorHardness m_softRigidClusterHardness m_softKineticClusterHardness m_softSoftClusterHardness m_softRigidClusterImpulseSplit m_softKineticClusterImpulseSplit m_softSoftClusterImpulseSplit m_maxVolume m_timeScale m_velocityIterations m_positionIterations m_driftIterations m_clusterIterations m_rot m_scale m_aqq m_com *m_positions *m_weights m_numPositions m_numWeigts m_bvolume m_bframe m_framexform m_locii m_invwi m_vimpulses[2] m_dimpulses[2] m_lv m_av *m_framerefs *m_nodeIndices *m_masses m_numFrameRefs m_numNodes m_numMasses m_idmass m_imass m_nvimpulses m_ndimpulses m_ndamping m_ldamping m_adamping m_matching m_maxSelfCollisionImpulse m_selfCollisionImpulseFactor m_containsAnchor m_collide m_clusterIndex *m_bodyA *m_bodyB m_refs[2] m_cfm m_split m_delete m_relPosition[2] m_bodyAtype m_bodyBtype m_jointType *m_pose **m_materials *m_nodes *m_links *m_faces *m_tetrahedra *m_anchors *m_clusters *m_joints m_numMaterials m_numLinks m_numFaces m_numTetrahedra m_numAnchors m_numClusters m_numJoints m_config TYPEL char uchar short ushort int long ulong float double void PointerArray btPhysicsSystem ListBase btVector3FloatData btVector3DoubleData btMatrix3x3FloatData btMatrix3x3DoubleData btTransformFloatData btTransformDoubleData btBvhSubtreeInfoData btOptimizedBvhNodeFloatData btOptimizedBvhNodeDoubleData btQuantizedBvhNodeData btQuantizedBvhFloatData btQuantizedBvhDoubleData btCollisionShapeData btStaticPlaneShapeData btConvexInternalShapeData btPositionAndRadius btMultiSphereShapeData btIntIndexData btShortIntIndexData btShortIntIndexTripletData btCharIndexTripletData btMeshPartData btStridingMeshInterfaceData btTriangleMeshShapeData btTriangleInfoMapData btScaledTriangleMeshShapeData btCompoundShapeChildData btCompoundShapeData btCylinderShapeData btCapsuleShapeData btTriangleInfoData btGImpactMeshShapeData btConvexHullShapeData btCollisionObjectDoubleData btCollisionObjectFloatData btDynamicsWorldDoubleData btContactSolverInfoDoubleData btDynamicsWorldFloatData btContactSolverInfoFloatData btRigidBodyFloatData btRigidBodyDoubleData btConstraintInfo1 btTypedConstraintData btRigidBodyData btPoint2PointConstraintFloatData btPoint2PointConstraintDoubleData btHingeConstraintDoubleData btHingeConstraintFloatData btConeTwistConstraintData btGeneric6DofConstraintData btGeneric6DofSpringConstraintData btSliderConstraintData SoftBodyMaterialData SoftBodyNodeData SoftBodyLinkData SoftBodyFaceData SoftBodyTetraData SoftRigidAnchorData SoftBodyConfigData SoftBodyPoseData SoftBodyClusterData btSoftBodyJointData btSoftBodyFloatData TLEN 0 0 ` @ ? 0 P ` ? 8 8 H 8 P H ` P @ @ H P ?? ? h X ?? @ ` ? h? ? h? h ( h ` h ? hp ?STRCA
|
/external/ceres-solver/internal/ceres/ |
compressed_row_sparse_matrix.cc | 518 const double* m_values = m.values(); local 530 const double v1 = m_values[idx1]; 532 values[program[cursor]] += v1 * m_values[idx2];
|
/external/apache-xml/src/main/java/org/apache/xml/serializer/ |
ToStream.java | 3317 private boolean m_values[]; field in class:ToStream.BoolStack [all...] |