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

1 2 3 4 56 7 8 91011>>

  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/CollisionShapes/
btConvexHullShape.cpp 36 m_unscaledPoints[i] = btVector3(point[0], point[1], point[2]);
46 void btConvexHullShape::setLocalScaling(const btVector3& scaling)
52 void btConvexHullShape::addPoint(const btVector3& point, bool recalculateLocalAabb)
60 btVector3 btConvexHullShape::localGetSupportingVertexWithoutMargin(const btVector3& vec)const
62 btVector3 supVec(btScalar(0.),btScalar(0.),btScalar(0.));
68 btVector3 scaled = vec * m_localScaling;
76 void btConvexHullShape::batchedUnitVectorGetSupportingVertexWithoutMargin(const btVector3* vectors,btVector3* supportVerticesOut,int numVectors) const
89 btVector3 vec = vectors[j] * m_localScaling; // dot(a*b,c) = dot(a,b*c
    [all...]
btBox2dShape.cpp 22 void btBox2dShape::getAabb(const btTransform& t,btVector3& aabbMin,btVector3& aabbMax) const
28 void btBox2dShape::calculateLocalInertia(btScalar mass,btVector3& inertia) const
31 btVector3 halfExtents = getHalfExtentsWithMargin();
btCollisionShape.cpp 32 void btCollisionShape::getBoundingSphere(btVector3& center,btScalar& radius) const
36 btVector3 aabbMin,aabbMax;
53 btVector3 center;
60 void btCollisionShape::calculateTemporalAabb(const btTransform& curTrans,const btVector3& linvel,const btVector3& angvel,btScalar timeStep, btVector3& temporalAabbMin,btVector3& temporalAabbMax) const
73 btVector3 linMotion = linvel*timeStep;
90 btVector3 angularMotion3d(angularMotion,angularMotion,angularMotion);
91 temporalAabbMin = btVector3(temporalAabbMinx,temporalAabbMiny,temporalAabbMinz)
    [all...]
btConcaveShape.h 48 virtual void processAllTriangles(btTriangleCallback* callback,const btVector3& aabbMin,const btVector3& aabbMax) const = 0;
btTriangleIndexVertexArray.h 74 mutable btVector3 m_aabbMin;
75 mutable btVector3 m_aabbMax;
127 virtual void setPremadeAabb(const btVector3& aabbMin, const btVector3& aabbMax ) const;
128 virtual void getPremadeAabb(btVector3* aabbMin, btVector3* aabbMax ) const;
btCapsuleShape.cpp 30 btVector3 btCapsuleShape::localGetSupportingVertexWithoutMargin(const btVector3& vec0)const
33 btVector3 supVec(0,0,0);
37 btVector3 vec = vec0;
48 btVector3 vtx;
55 btVector3 pos(0,0,0);
67 btVector3 pos(0,0,0);
83 void btCapsuleShape::batchedUnitVectorGetSupportingVertexWithoutMargin(const btVector3* vectors,btVector3* supportVerticesOut,int numVectors) const
92 const btVector3& vec = vectors[j]
    [all...]
btConvexShape.cpp 29 ///not supported on IBM SDK, until we fix the alignment of btVector3
51 void btConvexShape::project(const btTransform& trans, const btVector3& dir, btScalar& min, btScalar& max, btVector3& witnesPtMin,btVector3& witnesPtMax) const
53 btVector3 localAxis = dir*trans.getBasis();
54 btVector3 vtx1 = trans(localGetSupportingVertex(localAxis));
55 btVector3 vtx2 = trans(localGetSupportingVertex(-localAxis));
73 static btVector3 convexHullSupport (const btVector3& localDirOrg, const btVector3* points, int numPoints, const btVector3& localScaling
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/NarrowPhaseCollision/
btGjkCollisionDescription.h 20 #include "LinearMath/btVector3.h"
24 btVector3 m_firstDir;
btGjkEpaPenetrationDepthSolver.cpp 27 btVector3& v, btVector3& wWitnessOnA, btVector3& wWitnessOnB,
37 btVector3 guessVector(transformB.getOrigin()-transformA.getOrigin());
46 // debugDraw->drawLine(results.witnesses[1],results.witnesses[1]+results.normal,btVector3(255,0,0));
btSubSimplexConvexCast.cpp 48 btVector3 linVelA,linVelB;
58 btVector3 r = (linVelA-linVelB);
59 btVector3 v;
61 btVector3 supVertexA = fromA(m_convexA->localGetSupportingVertex(-r*fromA.getBasis()));
62 btVector3 supVertexB = fromB(m_convexB->localGetSupportingVertex(r*fromB.getBasis()));
66 btVector3 n;
69 btVector3 c;
80 btVector3 w,p;
146 result.m_normal = btVector3(btScalar(0.0), btScalar(0.0), btScalar(0.0));
152 btVector3 hitA,hitB
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/swig-src/collision/com/badlogic/gdx/physics/bullet/collision/
btConvexPolyhedron.java 92 public void setLocalCenter(btVector3 value) {
93 CollisionJNI.btConvexPolyhedron_localCenter_set(swigCPtr, this, btVector3.getCPtr(value), value);
96 public btVector3 getLocalCenter() {
98 return (cPtr == 0) ? null : new btVector3(cPtr, false);
101 public void setExtents(btVector3 value) {
102 CollisionJNI.btConvexPolyhedron_extents_set(swigCPtr, this, btVector3.getCPtr(value), value);
105 public btVector3 getExtents() {
107 return (cPtr == 0) ? null : new btVector3(cPtr, false);
118 public void setMC(btVector3 value) {
119 CollisionJNI.btConvexPolyhedron_mC_set(swigCPtr, this, btVector3.getCPtr(value), value)
    [all...]
btPointCollector.java 61 public void setNormalOnBInWorld(btVector3 value) {
62 CollisionJNI.btPointCollector_normalOnBInWorld_set(swigCPtr, this, btVector3.getCPtr(value), value);
65 public btVector3 getNormalOnBInWorld() {
67 return (cPtr == 0) ? null : new btVector3(cPtr, false);
70 public void setPointInWorld(btVector3 value) {
71 CollisionJNI.btPointCollector_pointInWorld_set(swigCPtr, this, btVector3.getCPtr(value), value);
74 public btVector3 getPointInWorld() {
76 return (cPtr == 0) ? null : new btVector3(cPtr, false);
btStorageResult.java 61 public void setNormalOnSurfaceB(btVector3 value) {
62 CollisionJNI.btStorageResult_normalOnSurfaceB_set(swigCPtr, this, btVector3.getCPtr(value), value);
65 public btVector3 getNormalOnSurfaceB() {
67 return (cPtr == 0) ? null : new btVector3(cPtr, false);
70 public void setClosestPointInB(btVector3 value) {
71 CollisionJNI.btStorageResult_closestPointInB_set(swigCPtr, this, btVector3.getCPtr(value), value);
74 public btVector3 getClosestPointInB() {
76 return (cPtr == 0) ? null : new btVector3(cPtr, false);
GIM_CONTACT.java 61 public void setPoint(btVector3 value) {
62 CollisionJNI.GIM_CONTACT_point_set(swigCPtr, this, btVector3.getCPtr(value), value);
65 public btVector3 getPoint() {
67 return (cPtr == 0) ? null : new btVector3(cPtr, false);
70 public void setNormal(btVector3 value) {
71 CollisionJNI.GIM_CONTACT_normal_set(swigCPtr, this, btVector3.getCPtr(value), value);
74 public btVector3 getNormal() {
76 return (cPtr == 0) ? null : new btVector3(cPtr, false);
127 public void interpolate_normals(btVector3 normals, int normal_count) {
128 CollisionJNI.GIM_CONTACT_interpolate_normals(swigCPtr, this, btVector3.getCPtr(normals), normals, normal_count)
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/Gimpact/
btContactProcessing.h 45 btVector3 m_point;
46 btVector3 m_normal;
65 GIM_CONTACT(const btVector3 &point,const btVector3 & normal,
92 SIMD_FORCE_INLINE void interpolate_normals( btVector3 * normals,int normal_count)
94 btVector3 vec_sum(m_normal);
120 const btVector3 &point,const btVector3 & normal,
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletDynamics/ConstraintSolver/
btGearConstraint.h 39 btVector3 m_axisInA;
40 btVector3 m_axisInB;
45 btGearConstraint(btRigidBody& rbA, btRigidBody& rbB, const btVector3& axisInA,const btVector3& axisInB, btScalar ratio=1.f);
54 void setAxisA(btVector3& axisA)
58 void setAxisB(btVector3& axisB)
66 const btVector3& getAxisA() const
70 const btVector3& getAxisB() const
btSolve2LinearConstraint.cpp 21 #include "LinearMath/btVector3.h"
32 const btVector3& invInertiaADiag,
34 const btVector3& linvelA,const btVector3& angvelA,
35 const btVector3& rel_posA1,
36 const btVector3& invInertiaBDiag,
38 const btVector3& linvelB,const btVector3& angvelB,
39 const btVector3& rel_posA2,
41 btScalar depthA, const btVector3& normalA,
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/swig-src/dynamics/com/badlogic/gdx/physics/bullet/dynamics/
btWheelInfo.java 105 public void setContactNormalWS(btVector3 value) {
106 DynamicsJNI.btWheelInfo_RaycastInfo_contactNormalWS_set(swigCPtr, this, btVector3.getCPtr(value), value);
109 public btVector3 getContactNormalWS() {
111 return (cPtr == 0) ? null : new btVector3(cPtr, false);
114 public void setContactPointWS(btVector3 value) {
115 DynamicsJNI.btWheelInfo_RaycastInfo_contactPointWS_set(swigCPtr, this, btVector3.getCPtr(value), value);
118 public btVector3 getContactPointWS() {
120 return (cPtr == 0) ? null : new btVector3(cPtr, false);
131 public void setHardPointWS(btVector3 value) {
132 DynamicsJNI.btWheelInfo_RaycastInfo_hardPointWS_set(swigCPtr, this, btVector3.getCPtr(value), value)
    [all...]
btSolverConstraint.java 62 public void setRelpos1CrossNormal(btVector3 value) {
63 DynamicsJNI.btSolverConstraint_relpos1CrossNormal_set(swigCPtr, this, btVector3.getCPtr(value), value);
66 public btVector3 getRelpos1CrossNormal() {
68 return (cPtr == 0) ? null : new btVector3(cPtr, false);
71 public void setContactNormal1(btVector3 value) {
72 DynamicsJNI.btSolverConstraint_contactNormal1_set(swigCPtr, this, btVector3.getCPtr(value), value);
75 public btVector3 getContactNormal1() {
77 return (cPtr == 0) ? null : new btVector3(cPtr, false);
80 public void setRelpos2CrossNormal(btVector3 value) {
81 DynamicsJNI.btSolverConstraint_relpos2CrossNormal_set(swigCPtr, this, btVector3.getCPtr(value), value)
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/swig/common/
gdxMathTypes.i 8 #include <LinearMath/btVector3.h>
15 CREATE_POOLED_TYPEMAP(btVector3, Vector3, "Lcom/badlogic/gdx/math/Vector3;", Vector3_to_btVector3, btVector3_to_Vector3);
16 ENABLE_POOLED_TYPEMAP(btVector3, Vector3, "Lcom/badlogic/gdx/math/Vector3;");
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletDynamics/Dynamics/
btRigidBody.cpp 35 btRigidBody::btRigidBody(btScalar mass, btMotionState *motionState, btCollisionShape *collisionShape, const btVector3 &localInertia)
117 btVector3 linVel,angVel;
127 void btRigidBody::getAabb(btVector3& aabbMin,btVector3& aabbMax) const
135 void btRigidBody::setGravity(const btVector3& acceleration)
191 btVector3 dir = m_linearVelocity.normalized();
205 btVector3 dir = m_angularVelocity.normalized();
231 void btRigidBody::setMassProps(btScalar mass, const btVector3& inertia)
261 btVector3 btRigidBody::getLocalInertia() const
264 btVector3 inertiaLocal
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletSoftBody/
btSoftBodyInternals.h 65 void processAllTriangles(btTriangleCallback* /*callback*/,const btVector3& /*aabbMin*/,const btVector3& /*aabbMax*/) const
72 virtual void getAabb(const btTransform& t,btVector3& aabbMin,btVector3& aabbMax) const
75 const btVector3 mins=m_body->m_bounds[0];
76 const btVector3 maxs=m_body->m_bounds[1];
77 const btVector3 crns[]={t*btVector3(mins.x(),mins.y(),mins.z()),
78 t*btVector3(maxs.x(),mins.y(),mins.z()),
79 t*btVector3(maxs.x(),maxs.y(),mins.z())
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/LinearMath/
btGrahamScan2dConvexHull.h 21 #include "btVector3.h"
24 struct GrahamVector3 : public btVector3
26 GrahamVector3(const btVector3& org, int orgIndex)
27 :btVector3(org),
37 btVector3 m_anchor;
38 btAngleCompareFunc(const btVector3& anchor)
59 inline void GrahamScanConvexHull2D(btAlignedObjectArray<GrahamVector3>& originalPoints, btAlignedObjectArray<GrahamVector3>& hull, const btVector3& normalAxis)
61 btVector3 axis0,axis1;
74 // const btVector3& left = originalPoints[i];
75 // const btVector3& right = originalPoints[0]
    [all...]
  /external/libgdx/extensions/gdx-bullet/jni/swig/linearmath/
linearmath.i 29 #include <LinearMath/btVector3.h>
31 %include <LinearMath/btVector3.h>
61 bool btGeometryUtil::isInside(btAlignedObjectArray<btVector3> const&, btVector3 const&, float)
143 %template(btVector3Array) btAlignedObjectArray<btVector3>;
  /external/libgdx/extensions/gdx-bullet/jni/src/bullet/BulletCollision/CollisionDispatch/
btCollisionWorld.h 80 #include "LinearMath/btVector3.h"
169 virtual void debugDrawObject(const btTransform& worldTransform, const btCollisionShape* shape, const btVector3& color);
187 const btVector3& hitNormalLocal,
198 btVector3 m_hitNormalLocal;
244 ClosestRayResultCallback(const btVector3& rayFromWorld,const btVector3& rayToWorld)
250 btVector3 m_rayFromWorld;//used to calculate hitPointWorld from hitFraction
251 btVector3 m_rayToWorld;
253 btVector3 m_hitNormalWorld;
254 btVector3 m_hitPointWorld
    [all...]

Completed in 1895 milliseconds

1 2 3 4 56 7 8 91011>>