HomeSort by relevance Sort by last modified time
    Searched refs:btVector3 (Results 101 - 125 of 340) sorted by null

1 2 3 45 6 7 8 91011>>

  /external/libgdx/extensions/gdx-bullet/jni/swig/collision/
btAxisSweep3.i 24 btAxisSweep3(const btVector3& worldAabbMin,const btVector3& worldAabbMax, unsigned short int maxHandles = 16384, btOverlappingPairCache* pairCache = 0, bool disableRaycastAccelerator = false);
30 bt32BitAxisSweep3(const btVector3& worldAabbMin,const btVector3& worldAabbMax, unsigned int maxHandles = 1500000, btOverlappingPairCache* pairCache = 0, bool disableRaycastAccelerator = false);
btManifoldPoint.i 57 void getLocalPointA(btVector3 &out) {
61 void setLocalPointA(const btVector3 &value) {
65 void getLocalPointB(btVector3 &out) {
69 void setLocalPointB(const btVector3 &value) {
73 void getPositionWorldOnA(btVector3 &out) {
77 void setPositionWorldOnA(const btVector3 &value) {
81 void getPositionWorldOnB(btVector3 &out) {
85 void setPositionWorldOnB(const btVector3 &value) {
89 void getNormalWorldOnB(btVector3 &out) {
93 void setNormalWorldOnB(const btVector3 &value)
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/CollisionShapes/
btMinkowskiSumShape.h 37 virtual btVector3 localGetSupportingVertexWithoutMargin(const btVector3& vec)const;
39 virtual void batchedUnitVectorGetSupportingVertexWithoutMargin(const btVector3* vectors,btVector3* supportVerticesOut,int numVectors) const;
42 virtual void calculateLocalInertia(btScalar mass,btVector3& inertia) const;
btPolyhedralConvexShape.cpp 55 btAlignedObjectArray<btVector3> orgVertices;
59 btVector3& newVertex = orgVertices.expand();
67 btAlignedObjectArray<btVector3> planeEquations;
70 btAlignedObjectArray<btVector3> shiftedPlaneEquations;
73 btVector3 plane = planeEquations[p];
79 btAlignedObjectArray<btVector3> tmpVertices;
83 conv.compute(&tmpVertices[0].getX(), sizeof(btVector3),tmpVertices.size(),0.f,0.f);
87 conv.compute(&orgVertices[0].getX(), sizeof(btVector3),orgVertices.size(),0.f,0.f);
92 btAlignedObjectArray<btVector3> faceNormals;
116 btVector3 edges[3]
    [all...]
btMultiSphereShape.cpp 25 btMultiSphereShape::btMultiSphereShape (const btVector3* positions,const btScalar* radi,int numSpheres)
47 btVector3 btMultiSphereShape::localGetSupportingVertexWithoutMargin(const btVector3& vec0)const
49 btVector3 supVec(0,0,0);
54 btVector3 vec = vec0;
65 btVector3 vtx;
68 const btVector3* pos = &m_localPositionArray[0];
74 btVector3 temp[128];
94 void btMultiSphereShape::batchedUnitVectorGetSupportingVertexWithoutMargin(const btVector3* vectors,btVector3* supportVerticesOut,int numVectors) cons
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/NarrowPhaseCollision/
btPolyhedralContactClipping.h 30 typedef btAlignedObjectArray<btVector3> btVertexArray;
35 static void clipHullAgainstHull(const btVector3& separatingNormal, const btConvexPolyhedron& hullA, const btConvexPolyhedron& hullB, const btTransform& transA,const btTransform& transB, const btScalar minDist, btScalar maxDist, btDiscreteCollisionDetectorInterface::Result& resultOut);
36 static void clipFaceAgainstHull(const btVector3& separatingNormal, const btConvexPolyhedron& hullA, const btTransform& transA, btVertexArray& worldVertsB1, const btScalar minDist, btScalar maxDist,btDiscreteCollisionDetectorInterface::Result& resultOut);
38 static bool findSeparatingAxis( const btConvexPolyhedron& hullA, const btConvexPolyhedron& hullB, const btTransform& transA,const btTransform& transB, btVector3& sep, btDiscreteCollisionDetectorInterface::Result& resultOut);
41 static void clipFace(const btVertexArray& pVtxIn, btVertexArray& ppVtxOut, const btVector3& planeNormalWS,btScalar planeEqWS);
btPolyhedralContactClipping.cpp 32 void btPolyhedralContactClipping::clipFace(const btVertexArray& pVtxIn, btVertexArray& ppVtxOut, const btVector3& planeNormalWS,btScalar planeEqWS)
41 btVector3 firstVertex=pVtxIn[pVtxIn.size()-1];
42 btVector3 endVertex = pVtxIn[0];
80 static bool TestSepAxis(const btConvexPolyhedron& hullA, const btConvexPolyhedron& hullB, const btTransform& transA,const btTransform& transB, const btVector3& sep_axis, btScalar& depth, btVector3& witnessPointA, btVector3& witnessPointB)
84 btVector3 witnesPtMinA,witnesPtMaxA;
85 btVector3 witnesPtMinB,witnesPtMaxB;
117 inline bool IsAlmostZero(const btVector3& v)
136 void InverseTransformPoint3x3(btVector3& out, const btVector3& in, const btTransform& tr
    [all...]
btRaycastCallback.cpp 26 btTriangleRaycastCallback::btTriangleRaycastCallback(const btVector3& from,const btVector3& to, unsigned int flags)
39 void btTriangleRaycastCallback::processTriangle(btVector3* triangle,int partId, int triangleIndex)
41 const btVector3 &vert0=triangle[0];
42 const btVector3 &vert1=triangle[1];
43 const btVector3 &vert2=triangle[2];
45 btVector3 v10; v10 = vert1 - vert0 ;
46 btVector3 v20; v20 = vert2 - vert0 ;
48 btVector3 triangleNormal; triangleNormal = v10.cross( v20 );
81 btVector3 point; point.setInterpolate3( m_from, m_to, distance)
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletDynamics/ConstraintSolver/
btContactConstraint.h 19 #include "LinearMath/btVector3.h"
61 btScalar resolveSingleCollision(btRigidBody* body1, class btCollisionObject* colObj2, const btVector3& contactPositionWorld,const btVector3& contactNormalOnB, const struct btContactSolverInfo& solverInfo,btScalar distance);
65 void resolveSingleBilateral(btRigidBody& body1, const btVector3& pos1,
66 btRigidBody& body2, const btVector3& pos2,
67 btScalar distance, const btVector3& normal,btScalar& impulse ,btScalar timeStep);
btPoint2PointConstraint.cpp 25 btPoint2PointConstraint::btPoint2PointConstraint(btRigidBody& rbA,btRigidBody& rbB, const btVector3& pivotInA,const btVector3& pivotInB)
34 btPoint2PointConstraint::btPoint2PointConstraint(btRigidBody& rbA,const btVector3& pivotInA)
49 btVector3 normal(0,0,0);
110 btVector3 a1 = body0_trans.getBasis()*getPivotInA();
112 btVector3* angular0 = (btVector3*)(info->m_J1angularAxis);
113 btVector3* angular1 = (btVector3*)(info->m_J1angularAxis+info->rowskip);
114 btVector3* angular2 = (btVector3*)(info->m_J1angularAxis+2*info->rowskip)
    [all...]
btGeneric6DofConstraint.h 30 #include "LinearMath/btVector3.h"
134 btScalar solveAngularLimits(btScalar timeStep,btVector3& axis, btScalar jacDiagABInv,btRigidBody * body0, btRigidBody * body1);
143 btVector3 m_lowerLimit;//!< the constraint lower limits
144 btVector3 m_upperLimit;//!< the constraint upper limits
145 btVector3 m_accumulatedImpulse;
151 btVector3 m_normalCFM;//!< Constraint force mixing factor
152 btVector3 m_stopERP;//!< Error tolerance factor when joint is at limit
153 btVector3 m_stopCFM;//!< Constraint force mixing factor when joint is at limit
156 btVector3 m_targetVelocity;//!< target motor velocity
157 btVector3 m_maxMotorForce;//!< max force on moto
    [all...]
btPoint2PointConstraint.h 19 #include "LinearMath/btVector3.h"
61 btVector3 m_pivotInA;
62 btVector3 m_pivotInB;
77 btPoint2PointConstraint(btRigidBody& rbA,btRigidBody& rbB, const btVector3& pivotInA,const btVector3& pivotInB);
79 btPoint2PointConstraint(btRigidBody& rbA,const btVector3& pivotInA);
94 void setPivotA(const btVector3& pivotA)
99 void setPivotB(const btVector3& pivotB)
104 const btVector3& getPivotInA() const
109 const btVector3& getPivotInB() cons
    [all...]
btContactConstraint.cpp 19 #include "LinearMath/btVector3.h"
65 #include "LinearMath/btVector3.h"
77 const btVector3& contactPositionWorld,
78 const btVector3& contactNormalOnB,
85 const btVector3& normal = contactNormalOnB;
87 btVector3 rel_pos1 = contactPositionWorld - body1->getWorldTransform().getOrigin();
88 btVector3 rel_pos2 = contactPositionWorld - colObj2->getWorldTransform().getOrigin();
90 btVector3 vel1 = body1->getVelocityInLocalPoint(rel_pos1);
91 btVector3 vel2 = body2? body2->getVelocityInLocalPoint(rel_pos2) : btVector3(0,0,0)
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/custom/gdx/collision/
ClosestNotMeConvexResultCallback.cpp 3 ClosestNotMeConvexResultCallback::ClosestNotMeConvexResultCallback (btCollisionObject* me,const btVector3& fromA,const btVector3& toA) :
17 btVector3 linVelA,linVelB;
19 linVelB = btVector3(0,0,0);//toB.getOrigin()-fromB.getOrigin();
21 btVector3 relativeVelocity = (linVelA-linVelB);
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/LinearMath/
btTransformUtil.h 25 SIMD_FORCE_INLINE btVector3 btAabbSupport(const btVector3& halfExtents,const btVector3& supportDir)
27 return btVector3(supportDir.x() < btScalar(0.0) ? -halfExtents.x() : halfExtents.x(),
43 static void integrateTransform(const btTransform& curTrans,const btVector3& linvel,const btVector3& angvel,btScalar timeStep,btTransform& predictedTransform)
55 btVector3 axis;
82 static void calculateVelocityQuaternion(const btVector3& pos0,const btVector3& pos1,const btQuaternion& orn0,const btQuaternion& orn1,btScalar timeStep,btVector3& linVel,btVector3& angVel
    [all...]
btVector3.h 79 /**@brief btVector3 can be used to represent 3D points and vectors.
80 * It has an un-used w component to suit 16-byte alignment when btVector3 is stored in containers. This extra component can be used by derived classes (Quaternion?) or by user
83 ATTRIBUTE_ALIGNED16(class) btVector3
119 SIMD_FORCE_INLINE btVector3()
131 SIMD_FORCE_INLINE btVector3(const btScalar& _x, const btScalar& _y, const btScalar& _z)
141 SIMD_FORCE_INLINE btVector3( btSimdFloat4 v)
147 SIMD_FORCE_INLINE btVector3(const btVector3& rhs)
153 SIMD_FORCE_INLINE btVector3&
154 operator=(const btVector3& v)
    [all...]
btConvexHull.h 22 #include "btVector3.h"
39 btAlignedObjectArray<btVector3> m_OutputVertices; // array of vertices
64 mVertexStride = sizeof(btVector3);
72 const btVector3 *vertices,
73 unsigned int stride = sizeof(btVector3))
101 const btVector3 *mVertices; // the array of vertices.
117 btVector3 normal;
119 btPlane(const btVector3 &n,btScalar d):normal(n),dist(d){}
144 btAlignedObjectArray<btVector3> vertices;
176 btVector3* mVertices
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/Gimpact/
btClipPolygon.h 31 SIMD_FORCE_INLINE btScalar bt_distance_point_plane(const btVector4 & plane,const btVector3 &point)
38 SIMD_FORCE_INLINE void bt_vec_blend(btVector3 &vr, const btVector3 &va,const btVector3 &vb, btScalar blend_factor)
45 const btVector3 & point0,
46 const btVector3 & point1,
49 btVector3 * clipped,
74 const btVector3 * polygon_points,
76 btVector3 * clipped)
124 const btVector3 & point0
    [all...]
gim_tri_collision.h 50 btVector3 m_points[MAX_TRI_CLIPPING];
79 GREAL margin, const btVector3 * points, GUINT point_count, DISTANCE_FUNC distance_func)
116 const btVector3 * points, GUINT point_count)
129 btVector3 m_vertices[3];
140 SIMD_FORCE_INLINE void get_normal(btVector3 &normal) const
157 SIMD_FORCE_INLINE void get_edge_plane(GUINT edge_index,const btVector3 &triangle_normal,btVector4 &plane) const
159 const btVector3 & e0 = m_vertices[edge_index];
160 const btVector3 & e1 = m_vertices[(edge_index+1)%3];
175 btVector3 zaxis;
179 btVector3 xaxis = m_vertices[1] - m_vertices[0]
    [all...]
btGImpactMassUtil.h 32 SIMD_FORCE_INLINE btVector3 gim_inertia_add_transformed(
33 const btVector3 & source_inertia, const btVector3 & added_inertia, const btTransform & transform)
48 return btVector3(source_inertia[0]+ix,source_inertia[1]+iy,source_inertia[2] + iz);
51 SIMD_FORCE_INLINE btVector3 gim_get_point_inertia(const btVector3 & point, btScalar mass)
56 return btVector3(mass*(y2+z2),mass*(x2+z2),mass*(x2+y2));
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletSoftBody/
btSoftBodyHelpers.h 77 const btVector3& from,
78 const btVector3& to,
83 const btVector3& corner00,
84 const btVector3& corner10,
85 const btVector3& corner01,
86 const btVector3& corner11,
93 const btVector3& corner00,
94 const btVector3& corner10,
95 const btVector3& corner01,
96 const btVector3& corner11
    [all...]
btSoftBody.h 49 btVector3 water_normal;
52 btVector3 m_gravity;
175 virtual btScalar Eval(const btVector3& x)=0;
183 typedef btAlignedObjectArray<btVector3> tVector3Array;
189 btVector3 m_normal; /* Outward normal */
196 btVector3 m_velocity; /* Velocity */
224 btVector3 m_x; // Position
225 btVector3 m_q; // Previous step position
226 btVector3 m_v; // Velocity
227 btVector3 m_f; // Force accumulato
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/CollisionDispatch/
btSphereBoxCollisionAlgorithm.h 25 #include "LinearMath/btVector3.h"
53 bool getSphereDistance( const btCollisionObjectWrapper* boxObjWrap, btVector3& v3PointOnBox, btVector3& normal, btScalar& penetrationDepth, const btVector3& v3SphereCenter, btScalar fRadius, btScalar maxContactDistance );
55 btScalar getSpherePenetration( btVector3 const &boxHalfExtent, btVector3 const &sphereRelPos, btVector3 &closestPoint, btVector3& normal );
  /external/libgdx/extensions/gdx-bullet/jni/swig-src/collision/com/badlogic/gdx/physics/bullet/collision/
btConvexPointCloudShape.java 65 public btConvexPointCloudShape(btVector3 points, int numPoints, Vector3 localScaling, boolean computeAabb) {
66 this(CollisionJNI.new_btConvexPointCloudShape__SWIG_1(btVector3.getCPtr(points), points, numPoints, localScaling, computeAabb), true);
69 public btConvexPointCloudShape(btVector3 points, int numPoints, Vector3 localScaling) {
70 this(CollisionJNI.new_btConvexPointCloudShape__SWIG_2(btVector3.getCPtr(points), points, numPoints, localScaling), true);
73 public void setPoints(btVector3 points, int numPoints, boolean computeAabb, Vector3 localScaling) {
74 CollisionJNI.btConvexPointCloudShape_setPoints__SWIG_0(swigCPtr, this, btVector3.getCPtr(points), points, numPoints, computeAabb, localScaling);
77 public void setPoints(btVector3 points, int numPoints, boolean computeAabb) {
78 CollisionJNI.btConvexPointCloudShape_setPoints__SWIG_1(swigCPtr, this, btVector3.getCPtr(points), points, numPoints, computeAabb);
81 public void setPoints(btVector3 points, int numPoints) {
82 CollisionJNI.btConvexPointCloudShape_setPoints__SWIG_2(swigCPtr, this, btVector3.getCPtr(points), points, numPoints)
    [all...]
btTriangle.java 61 public void setVertex0(btVector3 value) {
62 CollisionJNI.btTriangle_vertex0_set(swigCPtr, this, btVector3.getCPtr(value), value);
65 public btVector3 getVertex0() {
67 return (cPtr == 0) ? null : new btVector3(cPtr, false);
70 public void setVertex1(btVector3 value) {
71 CollisionJNI.btTriangle_vertex1_set(swigCPtr, this, btVector3.getCPtr(value), value);
74 public btVector3 getVertex1() {
76 return (cPtr == 0) ? null : new btVector3(cPtr, false);
79 public void setVertex2(btVector3 value) {
80 CollisionJNI.btTriangle_vertex2_set(swigCPtr, this, btVector3.getCPtr(value), value)
    [all...]

Completed in 190 milliseconds

1 2 3 45 6 7 8 91011>>