Skip navigation links
A B C D E F G H I J K L M N O P Q R S T U V W X Y Z 

A

a - Variable in class org.jbox2d.common.Sweep
World angles
a - Variable in class org.jbox2d.dynamics.contacts.Position
 
a0 - Variable in class org.jbox2d.common.Sweep
World angles
AABB - Class in org.jbox2d.collision
An axis-aligned bounding box.
AABB() - Constructor for class org.jbox2d.collision.AABB
Creates the default object, with vertices at 0,0 and 0,0.
AABB(AABB) - Constructor for class org.jbox2d.collision.AABB
Copies from the given object
AABB(Vec2, Vec2) - Constructor for class org.jbox2d.collision.AABB
Creates an AABB object using the given bounding vertices.
aabb - Variable in class org.jbox2d.collision.broadphase.DynamicTreeNode
Enlarged AABB
aabbExtension - Static variable in class org.jbox2d.common.Settings
This is used to fatten AABBs in the dynamic tree.
aabbMultiplier - Static variable in class org.jbox2d.common.Settings
This is used to fatten AABBs in the dynamic tree.
abs() - Method in class org.jbox2d.common.Mat22
Return the matrix composed of the absolute values of all elements.
abs(Mat22) - Static method in class org.jbox2d.common.Mat22
Return the matrix composed of the absolute values of all elements.
abs(float) - Static method in class org.jbox2d.common.MathUtils
 
abs(int) - Static method in class org.jbox2d.common.MathUtils
 
abs() - Method in class org.jbox2d.common.Vec2
Return a new vector that has positive components.
abs(Vec2) - Static method in class org.jbox2d.common.Vec2
 
absLocal() - Method in class org.jbox2d.common.Mat22
 
absLocal() - Method in class org.jbox2d.common.Vec2
 
absToOut(Mat22, Mat22) - Static method in class org.jbox2d.common.Mat22
 
absToOut(Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
active - Variable in class org.jbox2d.dynamics.BodyDef
Does this body start out active?
activeContacts - Variable in class org.jbox2d.dynamics.World
 
add(Mat22) - Method in class org.jbox2d.common.Mat22
Add this matrix to B, return the result.
add(Vec2) - Method in class org.jbox2d.common.Vec2
Return the sum of this vector and another; does not alter either one.
add(Vec3) - Method in class org.jbox2d.common.Vec3
 
add(Body) - Method in class org.jbox2d.dynamics.Island
 
add(Contact) - Method in class org.jbox2d.dynamics.Island
 
add(Joint) - Method in class org.jbox2d.dynamics.Island
 
addBody(Body) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJointDef
Adds a body to the group
addBodyAndJoint(Body, DistanceJoint) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJointDef
Adds a body and the pre-made distance joint.
addLocal(Mat22) - Method in class org.jbox2d.common.Mat22
Add B to this matrix locally.
addLocal(Vec2) - Method in class org.jbox2d.common.Vec2
Add another vector to this one and returns result - alters this vector.
addLocal(float, float) - Method in class org.jbox2d.common.Vec2
Adds values to this vector and returns result - alters this vector.
addLocal(Vec3) - Method in class org.jbox2d.common.Vec3
 
addPair(Object, Object) - Method in interface org.jbox2d.callbacks.PairCallback
 
addPair(Object, Object) - Method in class org.jbox2d.dynamics.ContactManager
Broad-phase callback.
advance(float) - Method in class org.jbox2d.common.Sweep
Advance the sweep forward, yielding a new initial state.
advance(float) - Method in class org.jbox2d.dynamics.Body
 
allowSleep - Variable in class org.jbox2d.dynamics.BodyDef
Set this flag to false if this body should never fall asleep.
alpha0 - Variable in class org.jbox2d.common.Sweep
Fraction of the current time step in the range [0,1] c0 and a0 are the positions at alpha0.
angle - Variable in class org.jbox2d.dynamics.BodyDef
The world angle of the body in radians.
angularA - Variable in class org.jbox2d.dynamics.joints.Jacobian
 
angularB - Variable in class org.jbox2d.dynamics.joints.Jacobian
 
angularDamping - Variable in class org.jbox2d.dynamics.BodyDef
Angular damping is use to reduce the angular velocity.
angularSleepTolerance - Static variable in class org.jbox2d.common.Settings
A body cannot sleep if its angular velocity is above this tolerance.
angularSlop - Static variable in class org.jbox2d.common.Settings
A small angle used as a collision and constraint tolerance.
angularVelocity - Variable in class org.jbox2d.dynamics.BodyDef
The angular velocity of the body.
appendFlags(int) - Method in class org.jbox2d.callbacks.DebugDraw
 
applyAngularImpulse(float) - Method in class org.jbox2d.dynamics.Body
Apply an angular impulse.
applyForce(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
Apply a force at a world point.
applyForceToCenter(Vec2) - Method in class org.jbox2d.dynamics.Body
Apply a force to the center of mass.
applyLinearImpulse(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
Apply an impulse at a point.
applyTorque(float) - Method in class org.jbox2d.dynamics.Body
Apply a torque.
atan2(float, float) - Static method in class org.jbox2d.common.MathUtils
 
awake - Variable in class org.jbox2d.dynamics.BodyDef
Is this body initially sleeping?

B

BasicPerformanceTest - Class in org.jbox2d.profile
 
BasicPerformanceTest(int, int) - Constructor for class org.jbox2d.profile.BasicPerformanceTest
 
baumgarte - Static variable in class org.jbox2d.common.Settings
This scale factor controls how fast overlap is resolved.
beginContact(Contact) - Method in interface org.jbox2d.callbacks.ContactListener
Called when two fixtures begin to touch.
BLACK - Static variable in class org.jbox2d.common.Color3f
 
BLUE - Static variable in class org.jbox2d.common.Color3f
 
Body - Class in org.jbox2d.dynamics
A rigid body.
Body(BodyDef, World) - Constructor for class org.jbox2d.dynamics.Body
 
bodyA - Variable in class org.jbox2d.dynamics.joints.JointDef
The first attached body.
bodyB - Variable in class org.jbox2d.dynamics.joints.JointDef
The second attached body.
BodyDef - Class in org.jbox2d.dynamics
A body definition holds all the data needed to construct a rigid body.
BodyDef() - Constructor for class org.jbox2d.dynamics.BodyDef
 
BodyType - Enum in org.jbox2d.dynamics
The body type.
box - Variable in class org.jbox2d.common.OBBViewportTransform
 
BroadPhase - Class in org.jbox2d.collision.broadphase
The broad-phase is used for computing pairs and performing volume queries and ray casts.
BroadPhase(BroadPhaseStrategy) - Constructor for class org.jbox2d.collision.broadphase.BroadPhase
 
broadphase - Variable in class org.jbox2d.dynamics.Profile
 
BroadPhaseStrategy - Interface in org.jbox2d.collision.broadphase
 
bufferMove(int) - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
bullet - Variable in class org.jbox2d.dynamics.BodyDef
Is this a fast moving body that should be prevented from tunneling through other moving bodies? Note that all bodies are prevented from tunneling through kinematic and static bodies.
BULLET_HIT_FLAG - Static variable in class org.jbox2d.dynamics.contacts.Contact
 

C

c - Variable in class org.jbox2d.common.Rot
 
c - Variable in class org.jbox2d.common.Sweep
Center world positions
c - Variable in class org.jbox2d.dynamics.contacts.Position
 
c0 - Variable in class org.jbox2d.common.Sweep
Center world positions
categoryBits - Variable in class org.jbox2d.dynamics.Filter
The collision category bits.
ceil(float) - Static method in class org.jbox2d.common.MathUtils
 
ceilPowerOf2(int) - Static method in class org.jbox2d.common.MathUtils
Rounds up the value to the nearest higher power^2 value.
center - Variable in class org.jbox2d.collision.shapes.MassData
The position of the shape's centroid relative to the shape's origin.
center - Variable in class org.jbox2d.common.OBBViewportTransform.OBB
 
centroid(Transform) - Method in class org.jbox2d.collision.shapes.PolygonShape
Get the centroid and apply the supplied transform.
centroidToOut(Transform, Vec2) - Method in class org.jbox2d.collision.shapes.PolygonShape
Get the centroid and apply the supplied transform.
ChainAndCircleContact - Class in org.jbox2d.dynamics.contacts
 
ChainAndCircleContact(IWorldPool) - Constructor for class org.jbox2d.dynamics.contacts.ChainAndCircleContact
 
ChainAndPolygonContact - Class in org.jbox2d.dynamics.contacts
 
ChainAndPolygonContact(IWorldPool) - Constructor for class org.jbox2d.dynamics.contacts.ChainAndPolygonContact
 
ChainShape - Class in org.jbox2d.collision.shapes
A chain shape is a free form sequence of line segments.
ChainShape() - Constructor for class org.jbox2d.collision.shapes.ChainShape
 
child1 - Variable in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
child2 - Variable in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
CircleContact - Class in org.jbox2d.dynamics.contacts
 
CircleContact(IWorldPool) - Constructor for class org.jbox2d.dynamics.contacts.CircleContact
 
CircleShape - Class in org.jbox2d.collision.shapes
A circle shape.
CircleShape() - Constructor for class org.jbox2d.collision.shapes.CircleShape
 
CircleStack<E> - Class in org.jbox2d.pooling.normal
 
CircleStack(int, int) - Constructor for class org.jbox2d.pooling.normal.CircleStack
 
clamp(float, float, float) - Static method in class org.jbox2d.common.MathUtils
Returns the closest value to 'a' that is in between 'low' and 'high'
clamp(Vec2, Vec2, Vec2) - Static method in class org.jbox2d.common.MathUtils
 
clampToOut(Vec2, Vec2, Vec2, Vec2) - Static method in class org.jbox2d.common.MathUtils
 
clear() - Method in class org.jbox2d.dynamics.Island
 
CLEAR_FORCES - Static variable in class org.jbox2d.dynamics.World
 
clearFlags(int) - Method in class org.jbox2d.callbacks.DebugDraw
 
clearForces() - Method in class org.jbox2d.dynamics.World
Call this after you are done with time steps to clear the forces.
clipSegmentToLine(Collision.ClipVertex[], Collision.ClipVertex[], Vec2, float, int) - Static method in class org.jbox2d.collision.Collision
Clipping for contact manifolds.
ClipVertex() - Constructor for class org.jbox2d.collision.Collision.ClipVertex
 
clone() - Method in class org.jbox2d.collision.shapes.ChainShape
 
clone() - Method in class org.jbox2d.collision.shapes.CircleShape
 
clone() - Method in class org.jbox2d.collision.shapes.EdgeShape
 
clone() - Method in class org.jbox2d.collision.shapes.MassData
Return a copy of this object.
clone() - Method in class org.jbox2d.collision.shapes.PolygonShape
 
clone() - Method in class org.jbox2d.collision.shapes.Shape
 
clone() - Method in class org.jbox2d.common.Mat22
Return a clone of this matrix.
clone() - Method in class org.jbox2d.common.Rot
 
clone() - Method in class org.jbox2d.common.Vec2
Return a copy of this vector.
clone() - Method in class org.jbox2d.common.Vec3
 
collide() - Method in class org.jbox2d.dynamics.ContactManager
This is the top level collision call for the time step.
collide - Variable in class org.jbox2d.dynamics.Profile
 
collideCircles(Manifold, CircleShape, Transform, CircleShape, Transform) - Method in class org.jbox2d.collision.Collision
Compute the collision manifold between two circles.
collideConnected - Variable in class org.jbox2d.dynamics.joints.JointDef
Set this flag to true if the attached bodies should collide.
collideEdgeAndCircle(Manifold, EdgeShape, Transform, CircleShape, Transform) - Method in class org.jbox2d.collision.Collision
 
collideEdgeAndPolygon(Manifold, EdgeShape, Transform, PolygonShape, Transform) - Method in class org.jbox2d.collision.Collision
 
collidePolygonAndCircle(Manifold, PolygonShape, Transform, CircleShape, Transform) - Method in class org.jbox2d.collision.Collision
Compute the collision manifold between a polygon and a circle.
collidePolygons(Manifold, PolygonShape, Transform, PolygonShape, Transform) - Method in class org.jbox2d.collision.Collision
Compute the collision manifold between two polygons.
Collision - Class in org.jbox2d.collision
Functions used for computing contact points, distance queries, and TOI queries.
Collision(IWorldPool) - Constructor for class org.jbox2d.collision.Collision
 
Collision.ClipVertex - Class in org.jbox2d.collision
Used for computing contact manifolds.
Collision.PointState - Enum in org.jbox2d.collision
This is used for determining the state of contact points.
Color3f - Class in org.jbox2d.common
Similar to javax.vecmath.Color3f holder
Color3f() - Constructor for class org.jbox2d.common.Color3f
 
Color3f(float, float, float) - Constructor for class org.jbox2d.common.Color3f
 
combine(AABB, AABB) - Method in class org.jbox2d.collision.AABB
Combine two AABBs into this one.
combine(AABB) - Method in class org.jbox2d.collision.AABB
Combines another aabb with this one
compareTo(Pair) - Method in class org.jbox2d.collision.broadphase.Pair
 
compareTo(ContactID) - Method in class org.jbox2d.collision.ContactID
 
computeAABB(AABB, Transform, int) - Method in class org.jbox2d.collision.shapes.ChainShape
 
computeAABB(AABB, Transform, int) - Method in class org.jbox2d.collision.shapes.CircleShape
 
computeAABB(AABB, Transform, int) - Method in class org.jbox2d.collision.shapes.EdgeShape
 
computeAABB(AABB, Transform, int) - Method in class org.jbox2d.collision.shapes.PolygonShape
 
computeAABB(AABB, Transform, int) - Method in class org.jbox2d.collision.shapes.Shape
Given a transform, compute the associated axis aligned bounding box for a child shape.
computeCentroidToOut(Vec2[], int, Vec2) - Method in class org.jbox2d.collision.shapes.PolygonShape
 
computeHeight() - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Compute the height of the tree.
computeHeight() - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
computeMass(MassData, float) - Method in class org.jbox2d.collision.shapes.ChainShape
 
computeMass(MassData, float) - Method in class org.jbox2d.collision.shapes.CircleShape
 
computeMass(MassData, float) - Method in class org.jbox2d.collision.shapes.EdgeShape
 
computeMass(MassData, float) - Method in class org.jbox2d.collision.shapes.PolygonShape
 
computeMass(MassData, float) - Method in class org.jbox2d.collision.shapes.Shape
Compute the mass properties of this shape using its dimensions and density.
ConstantVolumeJoint - Class in org.jbox2d.dynamics.joints
 
ConstantVolumeJoint(World, ConstantVolumeJointDef) - Constructor for class org.jbox2d.dynamics.joints.ConstantVolumeJoint
 
ConstantVolumeJointDef - Class in org.jbox2d.dynamics.joints
Definition for a ConstantVolumeJoint, which connects a group a bodies together so they maintain a constant volume within them.
ConstantVolumeJointDef() - Constructor for class org.jbox2d.dynamics.joints.ConstantVolumeJointDef
 
Contact - Class in org.jbox2d.dynamics.contacts
The class manages contact between two shapes.
Contact(IWorldPool) - Constructor for class org.jbox2d.dynamics.contacts.Contact
 
contact - Variable in class org.jbox2d.dynamics.contacts.ContactEdge
the contact
CONTACT_STACK_INIT_SIZE - Static variable in class org.jbox2d.common.Settings
 
contactCreateFcn(IWorldPool, Fixture, Fixture) - Method in interface org.jbox2d.dynamics.contacts.ContactCreator
 
ContactCreator - Interface in org.jbox2d.dynamics.contacts
 
contactDestroyFcn(IWorldPool, Contact) - Method in interface org.jbox2d.dynamics.contacts.ContactCreator
 
ContactEdge - Class in org.jbox2d.dynamics.contacts
A contact edge is used to connect bodies and contacts together in a contact graph where each body is a node and each contact is an edge.
ContactEdge() - Constructor for class org.jbox2d.dynamics.contacts.ContactEdge
 
ContactFilter - Class in org.jbox2d.callbacks
Implement this class to provide collision filtering.
ContactFilter() - Constructor for class org.jbox2d.callbacks.ContactFilter
 
ContactID - Class in org.jbox2d.collision
Contact ids to facilitate warm starting.
ContactID() - Constructor for class org.jbox2d.collision.ContactID
 
ContactID(ContactID) - Constructor for class org.jbox2d.collision.ContactID
 
ContactID.Type - Enum in org.jbox2d.collision
 
ContactImpulse - Class in org.jbox2d.callbacks
Contact impulses for reporting.
ContactImpulse() - Constructor for class org.jbox2d.callbacks.ContactImpulse
 
contactIndex - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
ContactListener - Interface in org.jbox2d.callbacks
Implement this class to get contact information.
ContactManager - Class in org.jbox2d.dynamics
Delegate of World.
ContactManager(World, BroadPhaseStrategy) - Constructor for class org.jbox2d.dynamics.ContactManager
 
contactPoolCount - Variable in class org.jbox2d.dynamics.World
 
ContactPositionConstraint - Class in org.jbox2d.dynamics.contacts
 
ContactPositionConstraint() - Constructor for class org.jbox2d.dynamics.contacts.ContactPositionConstraint
 
ContactRegister - Class in org.jbox2d.dynamics.contacts
 
ContactRegister() - Constructor for class org.jbox2d.dynamics.contacts.ContactRegister
 
contacts - Variable in class org.jbox2d.dynamics.contacts.ContactSolver.ContactSolverDef
 
ContactSolver - Class in org.jbox2d.dynamics.contacts
 
ContactSolver() - Constructor for class org.jbox2d.dynamics.contacts.ContactSolver
 
ContactSolver.ContactSolverDef - Class in org.jbox2d.dynamics.contacts
 
ContactSolverDef() - Constructor for class org.jbox2d.dynamics.contacts.ContactSolver.ContactSolverDef
 
ContactVelocityConstraint - Class in org.jbox2d.dynamics.contacts
 
ContactVelocityConstraint() - Constructor for class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
ContactVelocityConstraint.VelocityConstraintPoint - Class in org.jbox2d.dynamics.contacts
 
contains(AABB) - Method in class org.jbox2d.collision.AABB
Does this aabb contain the provided AABB.
cos(float) - Static method in class org.jbox2d.common.MathUtils
 
count - Variable in class org.jbox2d.callbacks.ContactImpulse
 
count - Variable in class org.jbox2d.collision.Distance.SimplexCache
 
count - Variable in class org.jbox2d.dynamics.contacts.ContactSolver.ContactSolverDef
 
create(Body, FixtureDef) - Method in class org.jbox2d.dynamics.Fixture
 
create(World, JointDef) - Static method in class org.jbox2d.dynamics.joints.Joint
 
createBody(BodyDef) - Method in class org.jbox2d.dynamics.World
create a rigid body given a definition.
createChain(Vec2[], int) - Method in class org.jbox2d.collision.shapes.ChainShape
Create a chain with isolated end vertices.
createFixture(FixtureDef) - Method in class org.jbox2d.dynamics.Body
Creates a fixture and attach it to this body.
createFixture(Shape, float) - Method in class org.jbox2d.dynamics.Body
Creates a fixture from a shape and attach it to this body.
createJoint(JointDef) - Method in class org.jbox2d.dynamics.World
create a joint to constrain bodies together.
createLoop(Vec2[], int) - Method in class org.jbox2d.collision.shapes.ChainShape
Create a loop.
createProxies(BroadPhase, Transform) - Method in class org.jbox2d.dynamics.Fixture
 
createProxy(AABB, Object) - Method in class org.jbox2d.collision.broadphase.BroadPhase
Create a proxy with an initial AABB.
createProxy(AABB, Object) - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Create a proxy.
createProxy(AABB, Object) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
createRotationalTransform(float) - Static method in class org.jbox2d.common.Mat22
 
createRotationalTransform(float, Mat22) - Static method in class org.jbox2d.common.Mat22
 
createScaleTransform(float) - Static method in class org.jbox2d.common.Mat22
 
createScaleTransform(float, Mat22) - Static method in class org.jbox2d.common.Mat22
 
creator - Variable in class org.jbox2d.dynamics.contacts.ContactRegister
 
cross(Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
cross(Vec2, float) - Static method in class org.jbox2d.common.Vec2
 
cross(float, Vec2) - Static method in class org.jbox2d.common.Vec2
 
cross(Vec3, Vec3) - Static method in class org.jbox2d.common.Vec3
 
crossToOut(Vec2, float, Vec2) - Static method in class org.jbox2d.common.Vec2
 
crossToOut(float, Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
crossToOut(Vec3, Vec3, Vec3) - Static method in class org.jbox2d.common.Vec3
 
crossToOutUnsafe(Vec2, float, Vec2) - Static method in class org.jbox2d.common.Vec2
 
crossToOutUnsafe(float, Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
crossToOutUnsafe(Vec3, Vec3, Vec3) - Static method in class org.jbox2d.common.Vec3
 

D

dampingRatio - Variable in class org.jbox2d.dynamics.joints.ConstantVolumeJointDef
 
dampingRatio - Variable in class org.jbox2d.dynamics.joints.DistanceJointDef
The damping ratio.
dampingRatio - Variable in class org.jbox2d.dynamics.joints.MouseJointDef
The damping ratio.
dampingRatio - Variable in class org.jbox2d.dynamics.joints.WeldJointDef
The damping ratio.
dampingRatio - Variable in class org.jbox2d.dynamics.joints.WheelJointDef
Suspension damping ratio, one indicates critical damping
DEBUG_SOLVER - Static variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
DebugDraw - Class in org.jbox2d.callbacks
Implement this abstract class to allow JBox2d to automatically draw your physics for debugging purposes.
DebugDraw(IViewportTransform) - Constructor for class org.jbox2d.callbacks.DebugDraw
 
DefaultWorldPool - Class in org.jbox2d.pooling.normal
Provides object pooling for all objects used in the engine.
DefaultWorldPool(int, int) - Constructor for class org.jbox2d.pooling.normal.DefaultWorldPool
 
DEG2RAD - Static variable in class org.jbox2d.common.MathUtils
Degrees to radians conversion factor
density - Variable in class org.jbox2d.dynamics.FixtureDef
The density, usually in kg/m^2
destroy(Contact) - Method in class org.jbox2d.dynamics.ContactManager
 
destroy() - Method in class org.jbox2d.dynamics.Fixture
 
destroy(Joint) - Static method in class org.jbox2d.dynamics.joints.Joint
 
destroyBody(Body) - Method in class org.jbox2d.dynamics.World
destroy a rigid body given a definition.
destroyFixture(Fixture) - Method in class org.jbox2d.dynamics.Body
Destroy a fixture.
destroyJoint(Joint) - Method in class org.jbox2d.dynamics.World
destroy a joint.
destroyProxies(BroadPhase) - Method in class org.jbox2d.dynamics.Fixture
Internal method
destroyProxy(int) - Method in class org.jbox2d.collision.broadphase.BroadPhase
Destroy a proxy.
destroyProxy(int) - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Destroy a proxy
destroyProxy(int) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
DestructionListener - Interface in org.jbox2d.callbacks
Joints and fixtures are destroyed when their associated body is destroyed.
destructor() - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
 
destructor() - Method in class org.jbox2d.dynamics.joints.Joint
Override to handle destruction of joint
Distance - Class in org.jbox2d.collision
This is non-static for faster pooling.
Distance() - Constructor for class org.jbox2d.collision.Distance
 
distance(DistanceOutput, Distance.SimplexCache, DistanceInput) - Method in class org.jbox2d.collision.Distance
Compute the closest points between two shapes.
distance - Variable in class org.jbox2d.collision.DistanceOutput
 
distance(Vec2, Vec2) - Static method in class org.jbox2d.common.MathUtils
 
Distance.DistanceProxy - Class in org.jbox2d.collision
A distance proxy is used by the GJK algorithm.
Distance.SimplexCache - Class in org.jbox2d.collision
Used to warm start Distance.
DistanceInput - Class in org.jbox2d.collision
Input for Distance.
DistanceInput() - Constructor for class org.jbox2d.collision.DistanceInput
 
DistanceJoint - Class in org.jbox2d.dynamics.joints
A distance joint constrains two points on two bodies to remain at a fixed distance from each other.
DistanceJoint(IWorldPool, DistanceJointDef) - Constructor for class org.jbox2d.dynamics.joints.DistanceJoint
 
DistanceJointDef - Class in org.jbox2d.dynamics.joints
Distance joint definition.
DistanceJointDef() - Constructor for class org.jbox2d.dynamics.joints.DistanceJointDef
 
DistanceOutput - Class in org.jbox2d.collision
Output for Distance.
DistanceOutput() - Constructor for class org.jbox2d.collision.DistanceOutput
 
DistanceProxy() - Constructor for class org.jbox2d.collision.Distance.DistanceProxy
 
distanceSquared(Vec2, Vec2) - Static method in class org.jbox2d.common.MathUtils
 
dot(Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
dot(Vec3, Vec3) - Static method in class org.jbox2d.common.Vec3
 
drawCircle(Vec2, float, Color3f) - Method in class org.jbox2d.callbacks.DebugDraw
Draw a circle.
drawDebugData() - Method in class org.jbox2d.dynamics.World
Call this to draw shapes and other debug draw data.
drawPoint(Vec2, float, Color3f) - Method in class org.jbox2d.callbacks.DebugDraw
 
drawPolygon(Vec2[], int, Color3f) - Method in class org.jbox2d.callbacks.DebugDraw
Draw a closed polygon provided in CCW order.
drawSegment(Vec2, Vec2, Color3f) - Method in class org.jbox2d.callbacks.DebugDraw
Draw a line segment.
drawSolidCircle(Vec2, float, Vec2, Color3f) - Method in class org.jbox2d.callbacks.DebugDraw
Draw a solid circle.
drawSolidPolygon(Vec2[], int, Color3f) - Method in class org.jbox2d.callbacks.DebugDraw
Draw a solid closed polygon provided in CCW order.
drawString(float, float, String, Color3f) - Method in class org.jbox2d.callbacks.DebugDraw
Draw a string.
drawString(Vec2, String, Color3f) - Method in class org.jbox2d.callbacks.DebugDraw
 
drawTransform(Transform) - Method in class org.jbox2d.callbacks.DebugDraw
Draw a transform.
drawTree(DebugDraw) - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
drawTree(DebugDraw) - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
 
drawTree(DebugDraw) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
drawTree(DebugDraw, DynamicTreeNode, int, int) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
dt - Variable in class org.jbox2d.dynamics.TimeStep
time step
dtRatio - Variable in class org.jbox2d.dynamics.TimeStep
dt * inv_dt0
dump(int) - Method in class org.jbox2d.dynamics.Fixture
Dump this fixture to the log file.
DynamicIntStack - Class in org.jbox2d.pooling.stacks
 
DynamicIntStack(int) - Constructor for class org.jbox2d.pooling.stacks.DynamicIntStack
 
DynamicTree - Class in org.jbox2d.collision.broadphase
A dynamic tree arranges data in a binary tree to accelerate queries such as volume queries and ray casts.
DynamicTree() - Constructor for class org.jbox2d.collision.broadphase.DynamicTree
 
DynamicTree.TreeNodeStack - Class in org.jbox2d.collision.broadphase
 
DynamicTreeNode - Class in org.jbox2d.collision.broadphase
 
DynamicTreeNode(int) - Constructor for class org.jbox2d.collision.broadphase.DynamicTreeNode
Should never be constructed outside the engine

E

e_aabbBit - Static variable in class org.jbox2d.callbacks.DebugDraw
 
e_activeFlag - Static variable in class org.jbox2d.dynamics.Body
 
e_autoSleepFlag - Static variable in class org.jbox2d.dynamics.Body
 
e_awakeFlag - Static variable in class org.jbox2d.dynamics.Body
 
e_bulletFlag - Static variable in class org.jbox2d.dynamics.Body
 
e_centerOfMassBit - Static variable in class org.jbox2d.callbacks.DebugDraw
 
e_dynamicTreeBit - Static variable in class org.jbox2d.callbacks.DebugDraw
 
e_fixedRotationFlag - Static variable in class org.jbox2d.dynamics.Body
 
e_islandFlag - Static variable in class org.jbox2d.dynamics.Body
 
e_jointBit - Static variable in class org.jbox2d.callbacks.DebugDraw
 
e_pairBit - Static variable in class org.jbox2d.callbacks.DebugDraw
 
e_shapeBit - Static variable in class org.jbox2d.callbacks.DebugDraw
 
e_toiFlag - Static variable in class org.jbox2d.dynamics.Body
 
EdgeAndCircleContact - Class in org.jbox2d.dynamics.contacts
 
EdgeAndCircleContact(IWorldPool) - Constructor for class org.jbox2d.dynamics.contacts.EdgeAndCircleContact
 
EdgeAndPolygonContact - Class in org.jbox2d.dynamics.contacts
 
EdgeAndPolygonContact(IWorldPool) - Constructor for class org.jbox2d.dynamics.contacts.EdgeAndPolygonContact
 
edgeSeparation(PolygonShape, Transform, int, PolygonShape, Transform) - Method in class org.jbox2d.collision.Collision
Find the separation between poly1 and poly2 for a given edge normal on poly1.
EdgeShape - Class in org.jbox2d.collision.shapes
A line segment (edge) shape.
EdgeShape() - Constructor for class org.jbox2d.collision.shapes.EdgeShape
 
ENABLED_FLAG - Static variable in class org.jbox2d.dynamics.contacts.Contact
 
enableLimit(boolean) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Enable/disable the joint limit.
enableLimit - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
Enable/disable the joint limit.
enableLimit(boolean) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
enableLimit - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
A flag to enable joint limits.
enableMotor(boolean) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Enable/disable the joint motor.
enableMotor - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
Enable/disable the joint motor.
enableMotor(boolean) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
enableMotor - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
A flag to enable the joint motor.
enableMotor(boolean) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
enableMotor - Variable in class org.jbox2d.dynamics.joints.WheelJointDef
Enable/disable the joint motor.
endContact(Contact) - Method in interface org.jbox2d.callbacks.ContactListener
Called when two fixtures cease to touch.
EPSILON - Static variable in class org.jbox2d.common.Settings
A "close to zero" float epsilon value for use
equals(Object) - Method in class org.jbox2d.common.Mat22
 
equals(Object) - Method in class org.jbox2d.common.Mat33
 
equals(Object) - Method in class org.jbox2d.common.Vec2
 
equals(Object) - Method in class org.jbox2d.common.Vec3
 
evaluate(Manifold, Transform, Transform) - Method in class org.jbox2d.dynamics.contacts.ChainAndCircleContact
 
evaluate(Manifold, Transform, Transform) - Method in class org.jbox2d.dynamics.contacts.ChainAndPolygonContact
 
evaluate(Manifold, Transform, Transform) - Method in class org.jbox2d.dynamics.contacts.CircleContact
 
evaluate(Manifold, Transform, Transform) - Method in class org.jbox2d.dynamics.contacts.Contact
 
evaluate(Manifold, Transform, Transform) - Method in class org.jbox2d.dynamics.contacts.EdgeAndCircleContact
 
evaluate(Manifold, Transform, Transform) - Method in class org.jbox2d.dynamics.contacts.EdgeAndPolygonContact
 
evaluate(Manifold, Transform, Transform) - Method in class org.jbox2d.dynamics.contacts.PolygonAndCircleContact
 
evaluate(Manifold, Transform, Transform) - Method in class org.jbox2d.dynamics.contacts.PolygonContact
 
ex - Variable in class org.jbox2d.common.Mat22
 
ex - Variable in class org.jbox2d.common.Mat33
 
extents - Variable in class org.jbox2d.common.OBBViewportTransform.OBB
 
ey - Variable in class org.jbox2d.common.Mat22
 
ey - Variable in class org.jbox2d.common.Mat33
 
ez - Variable in class org.jbox2d.common.Mat33
 

F

FAST_ABS - Static variable in class org.jbox2d.common.Settings
 
FAST_ATAN2 - Static variable in class org.jbox2d.common.Settings
 
FAST_CEIL - Static variable in class org.jbox2d.common.Settings
 
FAST_FLOOR - Static variable in class org.jbox2d.common.Settings
 
FAST_ROUND - Static variable in class org.jbox2d.common.Settings
 
fastAtan2(float, float) - Static method in class org.jbox2d.common.MathUtils
 
Filter - Class in org.jbox2d.dynamics
This holds contact filtering data.
Filter() - Constructor for class org.jbox2d.dynamics.Filter
 
filter - Variable in class org.jbox2d.dynamics.FixtureDef
Contact filtering data;
FILTER_FLAG - Static variable in class org.jbox2d.dynamics.contacts.Contact
 
findIncidentEdge(Collision.ClipVertex[], PolygonShape, Transform, int, PolygonShape, Transform) - Method in class org.jbox2d.collision.Collision
 
findMaxSeparation(Collision.EdgeResults, PolygonShape, Transform, PolygonShape, Transform) - Method in class org.jbox2d.collision.Collision
Find the max separation between poly1 and poly2 using edge normals from poly1.
findNewContacts() - Method in class org.jbox2d.dynamics.ContactManager
 
fixedRotation - Variable in class org.jbox2d.dynamics.BodyDef
Should this body be prevented from rotating? Useful for characters.
Fixture - Class in org.jbox2d.dynamics
A fixture is used to attach a shape to a body for collision detection.
Fixture() - Constructor for class org.jbox2d.dynamics.Fixture
 
FixtureDef - Class in org.jbox2d.dynamics
A fixture definition is used to create a fixture.
FixtureDef() - Constructor for class org.jbox2d.dynamics.FixtureDef
 
FixtureProxy - Class in org.jbox2d.dynamics
This proxy is used internally to connect fixtures to the broad-phase.
FixtureProxy() - Constructor for class org.jbox2d.dynamics.FixtureProxy
 
flagForFiltering() - Method in class org.jbox2d.dynamics.contacts.Contact
Flag this contact for filtering.
flip() - Method in class org.jbox2d.collision.ContactID
 
FloatArray - Class in org.jbox2d.pooling.arrays
Not thread safe float[] pooling.
FloatArray() - Constructor for class org.jbox2d.pooling.arrays.FloatArray
 
floor(float) - Static method in class org.jbox2d.common.MathUtils
 
fraction - Variable in class org.jbox2d.collision.RayCastOutput
 
frames - Static variable in class org.jbox2d.profile.PistonBenchmark
 
frequencyHz - Variable in class org.jbox2d.dynamics.joints.ConstantVolumeJointDef
 
frequencyHz - Variable in class org.jbox2d.dynamics.joints.DistanceJointDef
The mass-spring-damper frequency in Hertz.
frequencyHz - Variable in class org.jbox2d.dynamics.joints.MouseJointDef
The response speed.
frequencyHz - Variable in class org.jbox2d.dynamics.joints.WeldJointDef
The mass-spring-damper frequency in Hertz.
frequencyHz - Variable in class org.jbox2d.dynamics.joints.WheelJointDef
Suspension frequency, zero indicates no suspension
friction - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
friction - Variable in class org.jbox2d.dynamics.FixtureDef
The friction coefficient, usually in the range [0,1].
FrictionJoint - Class in org.jbox2d.dynamics.joints
 
FrictionJoint(IWorldPool, FrictionJointDef) - Constructor for class org.jbox2d.dynamics.joints.FrictionJoint
 
FrictionJointDef - Class in org.jbox2d.dynamics.joints
Friction joint definition.
FrictionJointDef() - Constructor for class org.jbox2d.dynamics.joints.FrictionJointDef
 

G

GearJoint - Class in org.jbox2d.dynamics.joints
A gear joint is used to connect two joints together.
GearJoint(IWorldPool, GearJointDef) - Constructor for class org.jbox2d.dynamics.joints.GearJoint
 
GearJointDef - Class in org.jbox2d.dynamics.joints
Gear joint definition.
GearJointDef() - Constructor for class org.jbox2d.dynamics.joints.GearJointDef
 
get(int) - Method in class org.jbox2d.pooling.arrays.FloatArray
 
get(int) - Method in class org.jbox2d.pooling.arrays.IntArray
 
get(int) - Method in class org.jbox2d.pooling.arrays.Vec2Array
 
getAABB(int) - Method in class org.jbox2d.dynamics.Fixture
Get the fixture's AABB.
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
No-op
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.GearJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.Joint
get the anchor point on bodyA in world coordinates.
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getAnchorA(Vec2) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
No-op
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.GearJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.Joint
get the anchor point on bodyB in world coordinates.
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getAnchorB(Vec2) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getAngle() - Method in class org.jbox2d.common.Mat22
Extract the angle from this matrix (assumed to be a rotation matrix).
getAngle() - Method in class org.jbox2d.common.Rot
 
getAngle() - Method in class org.jbox2d.dynamics.Body
Get the angle in radians.
getAngularDamping() - Method in class org.jbox2d.dynamics.Body
Get the angular damping of the body.
getAngularVelocity() - Method in class org.jbox2d.dynamics.Body
Get the angular velocity.
getAreaRatio() - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Get the ratio of the sum of the node areas to the root area.
getAreaRatio() - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
getAutoClearForces() - Method in class org.jbox2d.dynamics.World
Get the flag that controls automatic clearing of forces after each time step.
getBodies() - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
 
getBody() - Method in class org.jbox2d.dynamics.Fixture
Get the parent body of this fixture.
getBodyA() - Method in class org.jbox2d.dynamics.joints.Joint
get the first body attached to this joint.
getBodyB() - Method in class org.jbox2d.dynamics.joints.Joint
get the second body attached to this joint.
getBodyCount() - Method in class org.jbox2d.dynamics.World
Get the number of bodies.
getBodyList() - Method in class org.jbox2d.dynamics.World
Get the world body list.
getCenter() - Method in class org.jbox2d.collision.AABB
Get the center of the AABB
getCenter() - Method in interface org.jbox2d.common.IViewportTransform
center of the viewport.
getCenter() - Method in class org.jbox2d.common.OBBViewportTransform
 
getCenterToOut(Vec2) - Method in class org.jbox2d.collision.AABB
 
getChainCircleContactStack() - Method in interface org.jbox2d.pooling.IWorldPool
 
getChainCircleContactStack() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getChainPolyContactStack() - Method in interface org.jbox2d.pooling.IWorldPool
 
getChainPolyContactStack() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getChildCount() - Method in class org.jbox2d.collision.shapes.ChainShape
 
getChildCount() - Method in class org.jbox2d.collision.shapes.CircleShape
 
getChildCount() - Method in class org.jbox2d.collision.shapes.EdgeShape
 
getChildCount() - Method in class org.jbox2d.collision.shapes.PolygonShape
 
getChildCount() - Method in class org.jbox2d.collision.shapes.Shape
Get the number of child primitives
getChildEdge(EdgeShape, int) - Method in class org.jbox2d.collision.shapes.ChainShape
Get a child edge.
getChildIndexA() - Method in class org.jbox2d.dynamics.contacts.Contact
 
getChildIndexB() - Method in class org.jbox2d.dynamics.contacts.Contact
 
getCircleContactStack() - Method in interface org.jbox2d.pooling.IWorldPool
 
getCircleContactStack() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getCollideConnected() - Method in class org.jbox2d.dynamics.joints.Joint
 
getCollision() - Method in interface org.jbox2d.pooling.IWorldPool
 
getCollision() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getContactCount() - Method in class org.jbox2d.dynamics.World
Get the number of contacts (each may have 0 or more contact points).
getContactList() - Method in class org.jbox2d.dynamics.Body
Get the list of all contacts attached to this body.
getContactList() - Method in class org.jbox2d.dynamics.World
Get the world contact list.
getContactManager() - Method in class org.jbox2d.dynamics.World
Get the contact manager for testing purposes
getCos() - Method in class org.jbox2d.common.Rot
 
getCount() - Method in class org.jbox2d.collision.broadphase.DynamicTree.TreeNodeStack
 
getCount() - Method in class org.jbox2d.pooling.stacks.DynamicIntStack
 
getCurrentLengthA() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getCurrentLengthB() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getDampingRatio() - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
getDampingRatio() - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
getDampingRatio() - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getDensity() - Method in class org.jbox2d.dynamics.Fixture
 
getDistance() - Method in interface org.jbox2d.pooling.IWorldPool
 
getDistance() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getEdgeCircleContactStack() - Method in interface org.jbox2d.pooling.IWorldPool
 
getEdgeCircleContactStack() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getEdgePolyContactStack() - Method in interface org.jbox2d.pooling.IWorldPool
 
getEdgePolyContactStack() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getExtents() - Method in class org.jbox2d.collision.AABB
Get the extents of the AABB (half-widths).
getExtents() - Method in interface org.jbox2d.common.IViewportTransform
This is the half-width and half-height.
getExtents() - Method in class org.jbox2d.common.OBBViewportTransform
 
getExtentsToOut(Vec2) - Method in class org.jbox2d.collision.AABB
 
getFatAABB(int) - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
getFatAABB(int) - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
 
getFatAABB(int) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
getFilterData() - Method in class org.jbox2d.dynamics.Fixture
Get the contact filtering data.
getFixtureA() - Method in class org.jbox2d.dynamics.contacts.Contact
Get the first fixture in this contact.
getFixtureB() - Method in class org.jbox2d.dynamics.contacts.Contact
Get the second fixture in this contact.
getFixtureList() - Method in class org.jbox2d.dynamics.Body
Get the list of all fixtures attached to this body.
getFlags() - Method in class org.jbox2d.callbacks.DebugDraw
 
getFloatArray(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
getFloatArray(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getFrames(int) - Method in class org.jbox2d.profile.BasicPerformanceTest
 
getFrames(int) - Method in class org.jbox2d.profile.PistonBenchmark
 
getFrequency() - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
getFrequency() - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
getFrequency() - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getFriction() - Method in class org.jbox2d.dynamics.contacts.Contact
 
getFriction() - Method in class org.jbox2d.dynamics.Fixture
Get the coefficient of friction.
getGravity() - Method in class org.jbox2d.dynamics.World
Get the global gravity vector.
getGravityScale() - Method in class org.jbox2d.dynamics.Body
Get the gravity scale of the body.
getGroundAnchorA() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getGroundAnchorB() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getHeight() - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Compute the height of the binary tree in O(N) time.
getHeight() - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
getInertia() - Method in class org.jbox2d.dynamics.Body
Get the central rotational inertia of the body.
getInitializedArray(int) - Method in class org.jbox2d.pooling.arrays.FloatArray
 
getInitializedArray(int) - Method in class org.jbox2d.pooling.arrays.IntArray
 
getInitializedArray(int) - Method in class org.jbox2d.pooling.arrays.Vec2Array
 
getInsertionCount() - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
 
getInsertionCount() - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
getIntArray(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
getIntArray(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getInverse22(Mat33) - Method in class org.jbox2d.common.Mat33
 
getJoint1() - Method in class org.jbox2d.dynamics.joints.GearJoint
 
getJoint2() - Method in class org.jbox2d.dynamics.joints.GearJoint
 
getJointAngle() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getJointCount() - Method in class org.jbox2d.dynamics.World
Get the number of joints.
getJointList() - Method in class org.jbox2d.dynamics.Body
Get the list of all joints attached to this body.
getJointList() - Method in class org.jbox2d.dynamics.World
Get the world joint list.
getJoints() - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
 
getJointSpeed() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Get the current joint translation, usually in meters.
getJointSpeed() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getJointSpeed() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getJointTranslation() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getJointTranslation() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getKey() - Method in class org.jbox2d.collision.ContactID
 
getLength() - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
getLength1() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getLength2() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getLengthA() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getLengthB() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getLimitState() - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
getLinearDamping() - Method in class org.jbox2d.dynamics.Body
Get the linear damping of the body.
getLinearVelocity() - Method in class org.jbox2d.dynamics.Body
Get the linear velocity of the center of mass.
getLinearVelocityFromLocalPoint(Vec2) - Method in class org.jbox2d.dynamics.Body
Get the world velocity of a local point.
getLinearVelocityFromLocalPointToOut(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
 
getLinearVelocityFromWorldPoint(Vec2) - Method in class org.jbox2d.dynamics.Body
Get the world linear velocity of a world point attached to this body.
getLinearVelocityFromWorldPointToOut(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
 
getLocalAnchorA() - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
getLocalAnchorA() - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
getLocalAnchorA() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getLocalAnchorA() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getLocalAnchorA() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getLocalAnchorA() - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
getLocalAnchorA() - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getLocalAnchorA() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getLocalAnchorB() - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
getLocalAnchorB() - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
getLocalAnchorB() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getLocalAnchorB() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getLocalAnchorB() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getLocalAnchorB() - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
getLocalAnchorB() - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getLocalAnchorB() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getLocalAxisA() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getLocalAxisA() - Method in class org.jbox2d.dynamics.joints.WheelJoint
For serialization
getLocalCenter() - Method in class org.jbox2d.dynamics.Body
Get the local position of the center of mass.
getLocalPoint(Vec2) - Method in class org.jbox2d.dynamics.Body
Gets a local point relative to the body's origin given a world point.
getLocalPointToOut(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
 
getLocalVector(Vec2) - Method in class org.jbox2d.dynamics.Body
Gets a local vector given a world vector.
getLocalVectorToOut(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
 
getLocalVectorToOutUnsafe(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
 
getLowerLimit() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Get the lower joint limit, usually in meters.
getLowerLimit() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getManifold() - Method in class org.jbox2d.dynamics.contacts.Contact
Get the contact manifold.
getMass() - Method in class org.jbox2d.dynamics.Body
Get the total mass of the body.
getMassData(MassData) - Method in class org.jbox2d.dynamics.Body
Get the mass data of the body.
getMassData(MassData) - Method in class org.jbox2d.dynamics.Fixture
Get the mass data for this fixture.
getMaxBalance() - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Get the maximum balance of an node in the tree.
getMaxBalance() - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
getMaxForce() - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
getMaxForce() - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
getMaxLength() - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
getMaxMotorForce() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getMaxMotorTorque() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getMaxMotorTorque() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getMaxTorque() - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
getMilliseconds() - Method in class org.jbox2d.common.Timer
 
getMotorForce(float) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Get the current motor force, usually in N.
getMotorSpeed() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Get the motor speed, usually in meters per second.
getMotorSpeed() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getMotorSpeed() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getMotorTorque(float) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getMotorTorque(float) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getNext() - Method in class org.jbox2d.dynamics.Body
Get the next body in the world's body list.
getNext() - Method in class org.jbox2d.dynamics.contacts.Contact
Get the next contact in the world's contact list.
getNext() - Method in class org.jbox2d.dynamics.Fixture
Get the next fixture in the parent body's fixture list.
getNext() - Method in class org.jbox2d.dynamics.joints.Joint
get the next joint the world joint list.
getNormals() - Method in class org.jbox2d.collision.shapes.PolygonShape
Get the edge normal vectors.
getPerimeter() - Method in class org.jbox2d.collision.AABB
Gets the perimeter length
getPointStates(Collision.PointState[], Collision.PointState[], Manifold, Manifold) - Static method in class org.jbox2d.collision.Collision
Compute the point states given two manifolds.
getPolyCircleContactStack() - Method in interface org.jbox2d.pooling.IWorldPool
 
getPolyCircleContactStack() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getPolyContactStack() - Method in interface org.jbox2d.pooling.IWorldPool
 
getPolyContactStack() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getPool() - Method in class org.jbox2d.dynamics.World
 
getPosition() - Method in class org.jbox2d.dynamics.Body
Get the world body origin position.
getProfile() - Method in class org.jbox2d.dynamics.World
 
getProxyCount() - Method in class org.jbox2d.collision.broadphase.BroadPhase
Get the number of proxies.
getProxyCount() - Method in class org.jbox2d.dynamics.World
Get the number of broad-phase proxies.
getRadius() - Method in class org.jbox2d.collision.shapes.Shape
The radius of the underlying shape.
getRatio() - Method in class org.jbox2d.dynamics.joints.GearJoint
 
getRatio() - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
No-op
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
Get the reaction force given the inverse time step.
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.GearJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.Joint
get the reaction force on body2 at the joint anchor in Newtons.
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getReactionForce(float, Vec2) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
No-op
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
Get the reaction torque given the inverse time step.
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.GearJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.Joint
get the reaction torque on body2 in N*m.
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getReactionTorque(float) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getReferenceAngle() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
getReferenceAngle() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getReferenceAngle() - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
getRestitution() - Method in class org.jbox2d.dynamics.contacts.Contact
 
getRestitution() - Method in class org.jbox2d.dynamics.Fixture
Get the coefficient of restitution.
getScreenToWorld(Vec2) - Method in class org.jbox2d.callbacks.DebugDraw
takes the screen coordinates (argScreen) and returns the world coordinates
getScreenToWorld(float, float) - Method in class org.jbox2d.callbacks.DebugDraw
takes the screen coordinates and returns the world coordinates.
getScreenToWorld(Vec2, Vec2) - Method in interface org.jbox2d.common.IViewportTransform
takes the screen coordinates (argScreen) and puts the corresponding world coordinates in argWorld.
getScreenToWorld(Vec2, Vec2) - Method in class org.jbox2d.common.OBBViewportTransform
 
getScreenToWorldToOut(Vec2, Vec2) - Method in class org.jbox2d.callbacks.DebugDraw
 
getScreenToWorldToOut(float, float, Vec2) - Method in class org.jbox2d.callbacks.DebugDraw
takes the screen coordinates and puts the corresponding world coordinates in argWorld.
getScreenVectorToWorld(Vec2, Vec2) - Method in interface org.jbox2d.common.IViewportTransform
Transforms the given directional screen vector back to the world direction.
getScreenVectorToWorld(Vec2, Vec2) - Method in class org.jbox2d.common.OBBViewportTransform
 
getShape() - Method in class org.jbox2d.dynamics.Fixture
Get the child shape.
getSin() - Method in class org.jbox2d.common.Rot
 
getSpringDampingRatio() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getSpringFrequencyHz() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
getSupport(Vec2) - Method in class org.jbox2d.collision.Distance.DistanceProxy
Get the supporting vertex index in the given direction.
getSupport(Vec2) - Method in class org.jbox2d.collision.shapes.CircleShape
Get the supporting vertex index in the given direction.
getSupportVertex(Vec2) - Method in class org.jbox2d.collision.Distance.DistanceProxy
Get the supporting vertex in the given direction.
getSupportVertex(Vec2) - Method in class org.jbox2d.collision.shapes.CircleShape
Get the supporting vertex in the given direction.
getSymInverse33(Mat33) - Method in class org.jbox2d.common.Mat33
 
getTangentSpeed() - Method in class org.jbox2d.dynamics.contacts.Contact
 
getTarget() - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
getTestName(int) - Method in class org.jbox2d.profile.BasicPerformanceTest
 
getTestName(int) - Method in class org.jbox2d.profile.SettingsPerformanceTest
 
getTestTime(int) - Method in class org.jbox2d.profile.BasicPerformanceTest
 
getTimeOfImpact() - Method in interface org.jbox2d.pooling.IWorldPool
 
getTimeOfImpact() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getTransform() - Method in class org.jbox2d.common.OBBViewportTransform
gets the transform of the viewport, transforms around the center.
getTransform(Transform, float) - Method in class org.jbox2d.common.Sweep
Get the interpolated transform at a specific time.
getTransform() - Method in class org.jbox2d.dynamics.Body
Get the body transform for the body's origin.
getTreeBalance() - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
getTreeBalance() - Method in class org.jbox2d.dynamics.World
Gets the balance of the dynamic tree
getTreeHeight() - Method in class org.jbox2d.collision.broadphase.BroadPhase
Get the height of the embedded tree.
getTreeHeight() - Method in class org.jbox2d.dynamics.World
Gets the height of the dynamic tree
getTreeQuality() - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
getTreeQuality() - Method in class org.jbox2d.dynamics.World
Gets the quality of the dynamic tree
getType() - Method in class org.jbox2d.collision.shapes.Shape
Get the type of this shape.
getType() - Method in class org.jbox2d.dynamics.Body
 
getType() - Method in class org.jbox2d.dynamics.Fixture
Get the type of the child shape.
getType() - Method in class org.jbox2d.dynamics.joints.Joint
get the type of the concrete joint.
getUpperLimit() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Get the upper joint limit, usually in meters.
getUpperLimit() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
getUserData(int) - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
getUserData(int) - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
 
getUserData(int) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
getUserData() - Method in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
getUserData() - Method in class org.jbox2d.dynamics.Body
Get the user data pointer that was provided in the body definition.
getUserData() - Method in class org.jbox2d.dynamics.Fixture
Get the user data that was assigned in the fixture definition.
getUserData() - Method in class org.jbox2d.dynamics.joints.Joint
get the user data pointer.
getVec2Array(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
getVec2Array(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
getVertex(int) - Method in class org.jbox2d.collision.Distance.DistanceProxy
Get a vertex by index.
getVertex(int) - Method in class org.jbox2d.collision.shapes.CircleShape
Get a vertex by index.
getVertex(int) - Method in class org.jbox2d.collision.shapes.PolygonShape
Get a vertex by index.
getVertexCount() - Method in class org.jbox2d.collision.Distance.DistanceProxy
Get the vertex count.
getVertexCount() - Method in class org.jbox2d.collision.shapes.CircleShape
Get the vertex count.
getVertexCount() - Method in class org.jbox2d.collision.shapes.PolygonShape
Get the vertex count.
getVertices(Vec2[]) - Method in class org.jbox2d.collision.AABB
 
getVertices() - Method in class org.jbox2d.collision.shapes.PolygonShape
Get the vertices in local coordinates.
getViewportTranform() - Method in class org.jbox2d.callbacks.DebugDraw
 
getWorld() - Method in class org.jbox2d.dynamics.Body
Get the parent world of this body.
getWorldCenter() - Method in class org.jbox2d.dynamics.Body
Get the world position of the center of mass.
getWorldManifold(WorldManifold) - Method in class org.jbox2d.dynamics.contacts.Contact
Get the world manifold.
getWorldPoint(Vec2) - Method in class org.jbox2d.dynamics.Body
Get the world coordinates of a point given the local coordinates.
getWorldPointToOut(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
 
getWorldToScreen(Vec2) - Method in class org.jbox2d.callbacks.DebugDraw
takes the world coordinate (argWorld) and returns the screen coordinates.
getWorldToScreen(float, float) - Method in class org.jbox2d.callbacks.DebugDraw
Takes the world coordinates and returns the screen coordinates.
getWorldToScreen(Vec2, Vec2) - Method in interface org.jbox2d.common.IViewportTransform
takes the world coordinate (argWorld) puts the corresponding screen coordinate in argScreen.
getWorldToScreen(Vec2, Vec2) - Method in class org.jbox2d.common.OBBViewportTransform
 
getWorldToScreenToOut(Vec2, Vec2) - Method in class org.jbox2d.callbacks.DebugDraw
 
getWorldToScreenToOut(float, float, Vec2) - Method in class org.jbox2d.callbacks.DebugDraw
Takes the world coordinates and puts the corresponding screen coordinates in argScreen.
getWorldVector(Vec2) - Method in class org.jbox2d.dynamics.Body
Get the world coordinates of a vector given the local coordinates.
getWorldVectorToOut(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
 
getWorldVectorToOutUnsafe(Vec2, Vec2) - Method in class org.jbox2d.dynamics.Body
 
getWorldVectorToScreen(Vec2, Vec2) - Method in interface org.jbox2d.common.IViewportTransform
Transforms the given directional vector by the viewport transform (not positional)
getWorldVectorToScreen(Vec2, Vec2) - Method in class org.jbox2d.common.OBBViewportTransform
 
getXAxis(Vec2) - Method in class org.jbox2d.common.Rot
 
getYAxis(Vec2) - Method in class org.jbox2d.common.Rot
 
GJK_CALLS - Static variable in class org.jbox2d.collision.Distance
 
GJK_ITERS - Static variable in class org.jbox2d.collision.Distance
 
GJK_MAX_ITERS - Static variable in class org.jbox2d.collision.Distance
 
go() - Method in class org.jbox2d.profile.BasicPerformanceTest
 
gravityScale - Variable in class org.jbox2d.dynamics.BodyDef
Experimental: scales the inertia tensor.
GREEN - Static variable in class org.jbox2d.common.Color3f
 
groundAnchorA - Variable in class org.jbox2d.dynamics.joints.PulleyJointDef
The first ground anchor in world coordinates.
groundAnchorB - Variable in class org.jbox2d.dynamics.joints.PulleyJointDef
The second ground anchor in world coordinates.
groupIndex - Variable in class org.jbox2d.dynamics.Filter
Collision groups allow a certain group of objects to never collide (negative) or always collide (positive).

H

HALF_PI - Static variable in class org.jbox2d.common.MathUtils
 
hashCode() - Method in class org.jbox2d.common.Mat22
 
hashCode() - Method in class org.jbox2d.common.Mat33
 
hashCode() - Method in class org.jbox2d.common.Vec2
 
hashCode() - Method in class org.jbox2d.common.Vec3
 
height - Variable in class org.jbox2d.collision.broadphase.DynamicTreeNode
 

I

I - Variable in class org.jbox2d.collision.shapes.MassData
The rotational inertia of the shape about the local origin.
id - Variable in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
id - Variable in class org.jbox2d.collision.Collision.ClipVertex
 
id - Variable in class org.jbox2d.collision.ManifoldPoint
uniquely identifies a contact point between two shapes
IDENTITY - Static variable in class org.jbox2d.common.Mat33
 
IDynamicStack<E> - Interface in org.jbox2d.pooling
Same functionality of a regular java.util stack.
indexA - Variable in class org.jbox2d.collision.ContactID
 
indexA - Variable in class org.jbox2d.collision.Distance.SimplexCache
vertices on shape A
indexA - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
indexB - Variable in class org.jbox2d.collision.ContactID
 
indexB - Variable in class org.jbox2d.collision.Distance.SimplexCache
vertices on shape B
indexB - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
inflate(float) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
 
init(Fixture, int, Fixture, int) - Method in class org.jbox2d.dynamics.contacts.ChainAndCircleContact
 
init(Fixture, int, Fixture, int) - Method in class org.jbox2d.dynamics.contacts.ChainAndPolygonContact
 
init(Fixture, Fixture) - Method in class org.jbox2d.dynamics.contacts.CircleContact
 
init(Fixture, int, Fixture, int) - Method in class org.jbox2d.dynamics.contacts.Contact
initialization for pooling
init(ContactSolver.ContactSolverDef) - Method in class org.jbox2d.dynamics.contacts.ContactSolver
 
init(Fixture, int, Fixture, int) - Method in class org.jbox2d.dynamics.contacts.EdgeAndCircleContact
 
init(Fixture, int, Fixture, int) - Method in class org.jbox2d.dynamics.contacts.EdgeAndPolygonContact
 
init(Fixture, Fixture) - Method in class org.jbox2d.dynamics.contacts.PolygonAndCircleContact
 
init(Fixture, Fixture) - Method in class org.jbox2d.dynamics.contacts.PolygonContact
 
init(int, int, int, ContactListener) - Method in class org.jbox2d.dynamics.Island
 
INITIAL_NUM_CONSTRAINTS - Static variable in class org.jbox2d.dynamics.contacts.ContactSolver
For each solver, this is the initial number of constraints in the array, which expands as needed.
initialize(Manifold, Transform, float, Transform, float) - Method in class org.jbox2d.collision.WorldManifold
 
initialize(Body, Body, Vec2, Vec2) - Method in class org.jbox2d.dynamics.joints.DistanceJointDef
Initialize the bodies, anchors, and length using the world anchors.
initialize(Body, Body, Vec2) - Method in class org.jbox2d.dynamics.joints.FrictionJointDef
Initialize the bodies, anchors, axis, and reference angle using the world anchor and world axis.
initialize(Body, Body, Vec2, Vec2) - Method in class org.jbox2d.dynamics.joints.PrismaticJointDef
Initialize the bodies, anchors, axis, and reference angle using the world anchor and world axis.
initialize(Body, Body, Vec2, Vec2, Vec2, Vec2, float) - Method in class org.jbox2d.dynamics.joints.PulleyJointDef
Initialize the bodies, anchors, lengths, max lengths, and ratio using the world anchors.
initialize(Body, Body, Vec2) - Method in class org.jbox2d.dynamics.joints.RevoluteJointDef
Initialize the bodies, anchors, and reference angle using the world anchor.
initialize(Body, Body, Vec2) - Method in class org.jbox2d.dynamics.joints.WeldJointDef
Initialize the bodies, anchors, and reference angle using a world anchor point.
initialize(Body, Body, Vec2, Vec2) - Method in class org.jbox2d.dynamics.joints.WheelJointDef
 
initializeVelocityConstraints() - Method in class org.jbox2d.dynamics.contacts.ContactSolver
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.GearJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.Joint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
initVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
IntArray - Class in org.jbox2d.pooling.arrays
Not thread safe int[] pooling
IntArray() - Constructor for class org.jbox2d.pooling.arrays.IntArray
 
inv_dt - Variable in class org.jbox2d.dynamics.TimeStep
inverse time step (0 if dt == 0).
INV_PI - Static variable in class org.jbox2d.common.MathUtils
 
invert() - Method in class org.jbox2d.common.Mat22
Returns the inverted Mat22 - does NOT invert the matrix locally!
invertLocal() - Method in class org.jbox2d.common.Mat22
 
invertToOut(Mat22) - Method in class org.jbox2d.common.Mat22
 
invIA - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
invIB - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
invMassA - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
invMassB - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
IOrderedStack<E> - Interface in org.jbox2d.pooling
This stack assumes that when you push 'n' items back, you're pushing back the last 'n' items popped.
isActive() - Method in class org.jbox2d.dynamics.Body
Get the active state of the body.
isActive() - Method in class org.jbox2d.dynamics.joints.Joint
Short-cut function to determine if either body is inactive.
isAllowSleep() - Method in class org.jbox2d.dynamics.World
 
isAwake() - Method in class org.jbox2d.dynamics.Body
Get the sleeping state of this body.
isBullet() - Method in class org.jbox2d.dynamics.Body
Is this body treated like a bullet for continuous collision detection?
isContinuousPhysics() - Method in class org.jbox2d.dynamics.World
 
isEnabled() - Method in class org.jbox2d.dynamics.contacts.Contact
Has this contact been disabled?
isEqual(ContactID) - Method in class org.jbox2d.collision.ContactID
 
isFixedRotation() - Method in class org.jbox2d.dynamics.Body
Does this body have fixed rotation?
Island - Class in org.jbox2d.dynamics
This is an internal class.
Island() - Constructor for class org.jbox2d.dynamics.Island
 
ISLAND_FLAG - Static variable in class org.jbox2d.dynamics.contacts.Contact
 
isLeaf() - Method in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
isLimitEnabled() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Is the joint limit enabled?
isLimitEnabled() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
isLocked() - Method in class org.jbox2d.dynamics.World
Is the world locked (in the middle of a time step).
isMotorEnabled() - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Is the joint motor enabled?
isMotorEnabled() - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
isMotorEnabled() - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
isPowerOfTwo(int) - Static method in class org.jbox2d.common.MathUtils
 
isSensor() - Method in class org.jbox2d.dynamics.Fixture
Is this fixture a sensor (non-solid)?
isSensor - Variable in class org.jbox2d.dynamics.FixtureDef
A sensor shape collects contact information but never generates a collision response.
isSleepingAllowed() - Method in class org.jbox2d.dynamics.Body
Is this body allowed to sleep
isSleepingAllowed() - Method in class org.jbox2d.dynamics.World
 
isSubStepping() - Method in class org.jbox2d.dynamics.World
 
isTouching() - Method in class org.jbox2d.dynamics.contacts.Contact
Is this contact touching
isValid() - Method in class org.jbox2d.collision.AABB
Verify that the bounds are sorted
isValid() - Method in class org.jbox2d.common.Vec2
True if the vector represents a pair of valid, non-infinite floating point numbers.
isWarmStarting() - Method in class org.jbox2d.dynamics.World
 
isYFlip() - Method in interface org.jbox2d.common.IViewportTransform
 
isYFlip() - Method in class org.jbox2d.common.OBBViewportTransform
 
iterations - Variable in class org.jbox2d.collision.DistanceOutput
number of gjk iterations used
iters - Static variable in class org.jbox2d.profile.PistonBenchmark
 
IViewportTransform - Interface in org.jbox2d.common
This is the viewport transform used from drawing.
IWorldPool - Interface in org.jbox2d.pooling
World pool interface

J

Jacobian - Class in org.jbox2d.dynamics.joints
 
Jacobian() - Constructor for class org.jbox2d.dynamics.joints.Jacobian
 
Joint - Class in org.jbox2d.dynamics.joints
The base joint class.
Joint(IWorldPool, JointDef) - Constructor for class org.jbox2d.dynamics.joints.Joint
 
joint - Variable in class org.jbox2d.dynamics.joints.JointEdge
the joint
joint1 - Variable in class org.jbox2d.dynamics.joints.GearJointDef
The first revolute/prismatic joint attached to the gear joint.
joint2 - Variable in class org.jbox2d.dynamics.joints.GearJointDef
The second revolute/prismatic joint attached to the gear joint.
JointDef - Class in org.jbox2d.dynamics.joints
Joint definitions are used to construct joints.
JointDef() - Constructor for class org.jbox2d.dynamics.joints.JointDef
 
JointEdge - Class in org.jbox2d.dynamics.joints
A joint edge is used to connect bodies and joints together in a joint graph where each body is a node and each joint is an edge.
JointEdge() - Constructor for class org.jbox2d.dynamics.joints.JointEdge
 
JointType - Enum in org.jbox2d.dynamics.joints
 

K

K - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
k_errorTol - Static variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
k_maxConditionNumber - Static variable in class org.jbox2d.dynamics.contacts.ContactSolver
Ensure a reasonable condition number.

L

lambda - Variable in class org.jbox2d.common.RaycastResult
 
leaf - Variable in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
length() - Method in class org.jbox2d.common.Vec2
Return the length of this vector.
length - Variable in class org.jbox2d.dynamics.joints.DistanceJointDef
The equilibrium length between the anchor points.
lengthA - Variable in class org.jbox2d.dynamics.joints.PulleyJointDef
The a reference length for the segment attached to bodyA.
lengthB - Variable in class org.jbox2d.dynamics.joints.PulleyJointDef
The a reference length for the segment attached to bodyB.
lengthSquared() - Method in class org.jbox2d.common.Vec2
Return the squared length of this vector.
LimitState - Enum in org.jbox2d.dynamics.joints
 
linearA - Variable in class org.jbox2d.dynamics.joints.Jacobian
 
linearDamping - Variable in class org.jbox2d.dynamics.BodyDef
Linear damping is use to reduce the linear velocity.
linearSleepTolerance - Static variable in class org.jbox2d.common.Settings
A body cannot sleep if its linear velocity is above this tolerance.
linearSlop - Static variable in class org.jbox2d.common.Settings
A small length used as a collision and constraint tolerance.
linearVelocity - Variable in class org.jbox2d.dynamics.BodyDef
The linear velocity of the body in world co-ordinates.
localAnchorA - Variable in class org.jbox2d.dynamics.joints.DistanceJointDef
The local anchor point relative to body1's origin.
localAnchorA - Variable in class org.jbox2d.dynamics.joints.FrictionJointDef
The local anchor point relative to bodyA's origin.
localAnchorA - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
The local anchor point relative to body1's origin.
localAnchorA - Variable in class org.jbox2d.dynamics.joints.PulleyJointDef
The local anchor point relative to bodyA's origin.
localAnchorA - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
The local anchor point relative to body1's origin.
localAnchorA - Variable in class org.jbox2d.dynamics.joints.RopeJointDef
The local anchor point relative to bodyA's origin.
localAnchorA - Variable in class org.jbox2d.dynamics.joints.WeldJointDef
The local anchor point relative to body1's origin.
localAnchorA - Variable in class org.jbox2d.dynamics.joints.WheelJointDef
The local anchor point relative to body1's origin.
localAnchorB - Variable in class org.jbox2d.dynamics.joints.DistanceJointDef
The local anchor point relative to body2's origin.
localAnchorB - Variable in class org.jbox2d.dynamics.joints.FrictionJointDef
The local anchor point relative to bodyB's origin.
localAnchorB - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
The local anchor point relative to body2's origin.
localAnchorB - Variable in class org.jbox2d.dynamics.joints.PulleyJointDef
The local anchor point relative to bodyB's origin.
localAnchorB - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
The local anchor point relative to body2's origin.
localAnchorB - Variable in class org.jbox2d.dynamics.joints.RopeJointDef
The local anchor point relative to bodyB's origin.
localAnchorB - Variable in class org.jbox2d.dynamics.joints.WeldJointDef
The local anchor point relative to body2's origin.
localAnchorB - Variable in class org.jbox2d.dynamics.joints.WheelJointDef
The local anchor point relative to body2's origin.
localAxisA - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
The local translation axis in body1.
localAxisA - Variable in class org.jbox2d.dynamics.joints.WheelJointDef
The local translation axis in body1.
localCenter - Variable in class org.jbox2d.common.Sweep
Local center of mass position
localNormal - Variable in class org.jbox2d.collision.Manifold
not use for Type::e_points
localPoint - Variable in class org.jbox2d.collision.Manifold
usage depends on manifold type
localPoint - Variable in class org.jbox2d.collision.ManifoldPoint
usage depends on manifold type
LOCKED - Static variable in class org.jbox2d.dynamics.World
 
lowerAngle - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
The lower angle for the joint limit (radians).
lowerBound - Variable in class org.jbox2d.collision.AABB
Bottom left vertex of bounding box.
lowerTranslation - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
The lower translation limit, usually in meters.

M

m_angularDamping - Variable in class org.jbox2d.dynamics.Body
 
m_angularVelocity - Variable in class org.jbox2d.dynamics.Body
 
m_bodies - Variable in class org.jbox2d.dynamics.Island
 
m_body - Variable in class org.jbox2d.dynamics.Fixture
 
m_bodyA - Variable in class org.jbox2d.dynamics.joints.Joint
 
m_bodyB - Variable in class org.jbox2d.dynamics.joints.Joint
 
m_bodyCapacity - Variable in class org.jbox2d.dynamics.Island
 
m_bodyCount - Variable in class org.jbox2d.dynamics.Island
 
m_broadPhase - Variable in class org.jbox2d.dynamics.ContactManager
 
m_buffer - Variable in class org.jbox2d.collision.Distance.DistanceProxy
 
m_centroid - Variable in class org.jbox2d.collision.shapes.PolygonShape
Local position of the shape centroid in parent body frame.
m_contactCapacity - Variable in class org.jbox2d.dynamics.Island
 
m_contactCount - Variable in class org.jbox2d.dynamics.ContactManager
 
m_contactCount - Variable in class org.jbox2d.dynamics.Island
 
m_contactFilter - Variable in class org.jbox2d.dynamics.ContactManager
 
m_contactList - Variable in class org.jbox2d.dynamics.Body
 
m_contactList - Variable in class org.jbox2d.dynamics.ContactManager
 
m_contactListener - Variable in class org.jbox2d.dynamics.ContactManager
 
m_contactManager - Variable in class org.jbox2d.dynamics.World
 
m_contacts - Variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
m_contacts - Variable in class org.jbox2d.dynamics.Island
 
m_count - Variable in class org.jbox2d.collision.Distance.DistanceProxy
 
m_count - Variable in class org.jbox2d.collision.shapes.ChainShape
 
m_count - Variable in class org.jbox2d.collision.shapes.PolygonShape
Number of active vertices in the shape.
m_count - Variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
m_density - Variable in class org.jbox2d.dynamics.Fixture
 
m_drawFlags - Variable in class org.jbox2d.callbacks.DebugDraw
 
m_edgeA - Variable in class org.jbox2d.dynamics.joints.Joint
 
m_edgeB - Variable in class org.jbox2d.dynamics.joints.Joint
 
m_filter - Variable in class org.jbox2d.dynamics.Fixture
 
m_fixtureA - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_fixtureB - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_fixtureCount - Variable in class org.jbox2d.dynamics.Body
 
m_fixtureList - Variable in class org.jbox2d.dynamics.Body
 
m_flags - Variable in class org.jbox2d.dynamics.Body
 
m_flags - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_flags - Variable in class org.jbox2d.dynamics.World
 
m_force - Variable in class org.jbox2d.dynamics.Body
 
m_friction - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_friction - Variable in class org.jbox2d.dynamics.Fixture
 
m_gravityScale - Variable in class org.jbox2d.dynamics.Body
 
m_hasNextVertex - Variable in class org.jbox2d.collision.shapes.ChainShape
 
m_hasPrevVertex - Variable in class org.jbox2d.collision.shapes.ChainShape
 
m_hasVertex0 - Variable in class org.jbox2d.collision.shapes.EdgeShape
 
m_hasVertex3 - Variable in class org.jbox2d.collision.shapes.EdgeShape
 
m_I - Variable in class org.jbox2d.dynamics.Body
 
m_indexA - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_indexB - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_invI - Variable in class org.jbox2d.dynamics.Body
 
m_invMass - Variable in class org.jbox2d.dynamics.Body
 
m_islandFlag - Variable in class org.jbox2d.dynamics.joints.Joint
 
m_islandIndex - Variable in class org.jbox2d.dynamics.Body
 
m_isSensor - Variable in class org.jbox2d.dynamics.Fixture
 
m_joint1 - Variable in class org.jbox2d.profile.PistonBenchmark
 
m_joint2 - Variable in class org.jbox2d.profile.PistonBenchmark
 
m_jointCapacity - Variable in class org.jbox2d.dynamics.Island
 
m_jointCount - Variable in class org.jbox2d.dynamics.Island
 
m_jointList - Variable in class org.jbox2d.dynamics.Body
 
m_joints - Variable in class org.jbox2d.dynamics.Island
 
m_linearDamping - Variable in class org.jbox2d.dynamics.Body
 
m_linearVelocity - Variable in class org.jbox2d.dynamics.Body
 
m_listener - Variable in class org.jbox2d.dynamics.Island
 
m_localAnchorA - Variable in class org.jbox2d.dynamics.joints.PrismaticJoint
 
m_localAnchorA - Variable in class org.jbox2d.dynamics.joints.RevoluteJoint
 
m_localAnchorB - Variable in class org.jbox2d.dynamics.joints.PrismaticJoint
 
m_localAnchorB - Variable in class org.jbox2d.dynamics.joints.RevoluteJoint
 
m_localXAxisA - Variable in class org.jbox2d.dynamics.joints.PrismaticJoint
 
m_localYAxisA - Variable in class org.jbox2d.dynamics.joints.PrismaticJoint
 
m_manifold - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_mass - Variable in class org.jbox2d.dynamics.Body
 
m_next - Variable in class org.jbox2d.dynamics.Body
 
m_next - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_next - Variable in class org.jbox2d.dynamics.Fixture
 
m_next - Variable in class org.jbox2d.dynamics.joints.Joint
 
m_nextVertex - Variable in class org.jbox2d.collision.shapes.ChainShape
 
m_nodeA - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_nodeB - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_normals - Variable in class org.jbox2d.collision.shapes.PolygonShape
The normals of the shape.
m_p - Variable in class org.jbox2d.collision.shapes.CircleShape
 
m_positionConstraints - Variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
m_positions - Variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
m_positions - Variable in class org.jbox2d.dynamics.Island
 
m_prev - Variable in class org.jbox2d.dynamics.Body
 
m_prev - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_prev - Variable in class org.jbox2d.dynamics.joints.Joint
 
m_prevVertex - Variable in class org.jbox2d.collision.shapes.ChainShape
 
m_proxies - Variable in class org.jbox2d.dynamics.Fixture
 
m_proxyCount - Variable in class org.jbox2d.dynamics.Fixture
 
m_radius - Variable in class org.jbox2d.collision.Distance.DistanceProxy
 
m_radius - Variable in class org.jbox2d.collision.shapes.Shape
 
m_referenceAngle - Variable in class org.jbox2d.dynamics.joints.PrismaticJoint
 
m_referenceAngle - Variable in class org.jbox2d.dynamics.joints.RevoluteJoint
 
m_restitution - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_restitution - Variable in class org.jbox2d.dynamics.Fixture
 
m_shape - Variable in class org.jbox2d.dynamics.Fixture
 
m_sleepTime - Variable in class org.jbox2d.dynamics.Body
 
m_step - Variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
m_sweep - Variable in class org.jbox2d.dynamics.Body
The swept motion for CCD
m_tangentSpeed - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_toi - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_toiCount - Variable in class org.jbox2d.dynamics.contacts.Contact
 
m_torque - Variable in class org.jbox2d.dynamics.Body
 
m_type - Variable in class org.jbox2d.collision.shapes.Shape
 
m_type - Variable in class org.jbox2d.dynamics.Body
 
m_userData - Variable in class org.jbox2d.dynamics.Body
 
m_userData - Variable in class org.jbox2d.dynamics.Fixture
 
m_userData - Variable in class org.jbox2d.dynamics.joints.Joint
 
m_velocities - Variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
m_velocities - Variable in class org.jbox2d.dynamics.Island
 
m_velocityConstraints - Variable in class org.jbox2d.dynamics.contacts.ContactSolver
 
m_vertex0 - Variable in class org.jbox2d.collision.shapes.EdgeShape
optional adjacent vertex 1.
m_vertex1 - Variable in class org.jbox2d.collision.shapes.EdgeShape
edge vertex 1
m_vertex2 - Variable in class org.jbox2d.collision.shapes.EdgeShape
edge vertex 2
m_vertex3 - Variable in class org.jbox2d.collision.shapes.EdgeShape
optional adjacent vertex 2.
m_vertices - Variable in class org.jbox2d.collision.Distance.DistanceProxy
 
m_vertices - Variable in class org.jbox2d.collision.shapes.ChainShape
 
m_vertices - Variable in class org.jbox2d.collision.shapes.PolygonShape
The vertices of the shape.
m_world - Variable in class org.jbox2d.dynamics.Body
 
m_xf - Variable in class org.jbox2d.dynamics.Body
The body origin transform.
main(String[]) - Static method in class org.jbox2d.profile.PistonBenchmark
 
Manifold - Class in org.jbox2d.collision
A manifold for two touching convex shapes.
Manifold() - Constructor for class org.jbox2d.collision.Manifold
creates a manifold with 0 points, with it's points array full of instantiated ManifoldPoints.
Manifold(Manifold) - Constructor for class org.jbox2d.collision.Manifold
Creates this manifold as a copy of the other
Manifold.ManifoldType - Enum in org.jbox2d.collision
 
ManifoldPoint - Class in org.jbox2d.collision
A manifold point is a contact point belonging to a contact manifold.
ManifoldPoint() - Constructor for class org.jbox2d.collision.ManifoldPoint
Blank manifold point with everything zeroed out.
ManifoldPoint(ManifoldPoint) - Constructor for class org.jbox2d.collision.ManifoldPoint
Creates a manifold point as a copy of the given point
map(float, float, float, float, float) - Static method in class org.jbox2d.common.MathUtils
 
maskBits - Variable in class org.jbox2d.dynamics.Filter
The collision mask bits.
mass - Variable in class org.jbox2d.collision.shapes.MassData
The mass of the shape, usually in kilograms.
MassData - Class in org.jbox2d.collision.shapes
This holds the mass data computed for a shape.
MassData() - Constructor for class org.jbox2d.collision.shapes.MassData
Blank mass data
MassData(MassData) - Constructor for class org.jbox2d.collision.shapes.MassData
Copies from the given mass data
Mat22 - Class in org.jbox2d.common
A 2-by-2 matrix.
Mat22() - Constructor for class org.jbox2d.common.Mat22
Construct zero matrix.
Mat22(Vec2, Vec2) - Constructor for class org.jbox2d.common.Mat22
Create a matrix with given vectors as columns.
Mat22(float, float, float, float) - Constructor for class org.jbox2d.common.Mat22
Create a matrix from four floats.
Mat33 - Class in org.jbox2d.common
A 3-by-3 matrix.
Mat33() - Constructor for class org.jbox2d.common.Mat33
 
Mat33(Vec3, Vec3, Vec3) - Constructor for class org.jbox2d.common.Mat33
 
MathUtils - Class in org.jbox2d.common
A few math methods that don't fit very well anywhere else.
MathUtils() - Constructor for class org.jbox2d.common.MathUtils
 
max(float, float) - Static method in class org.jbox2d.common.MathUtils
 
max(int, int) - Static method in class org.jbox2d.common.MathUtils
 
max(Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
MAX_ITERATIONS - Static variable in class org.jbox2d.collision.TimeOfImpact
 
MAX_STACK_SIZE - Static variable in class org.jbox2d.collision.broadphase.DynamicTree
 
maxAngularCorrection - Static variable in class org.jbox2d.common.Settings
The maximum angular position correction used when solving constraints.
maxForce - Variable in class org.jbox2d.dynamics.joints.FrictionJointDef
The maximum friction force in N.
maxForce - Variable in class org.jbox2d.dynamics.joints.MouseJointDef
The maximum constraint force that can be exerted to move the candidate body.
maxFraction - Variable in class org.jbox2d.collision.RayCastInput
 
maxLength - Variable in class org.jbox2d.dynamics.joints.RopeJointDef
The maximum length of the rope.
maxLinearCorrection - Static variable in class org.jbox2d.common.Settings
The maximum linear position correction used when solving constraints.
maxManifoldPoints - Static variable in class org.jbox2d.common.Settings
The maximum number of contact points between two convex shapes.
maxMotorForce - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
The maximum motor torque, usually in N-m.
maxMotorTorque - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
The maximum motor torque used to achieve the desired motor speed.
maxMotorTorque - Variable in class org.jbox2d.dynamics.joints.WheelJointDef
The maximum motor torque, usually in N-m.
maxPolygonVertices - Static variable in class org.jbox2d.common.Settings
The maximum number of vertices on a convex polygon.
maxRotation - Static variable in class org.jbox2d.common.Settings
The maximum angular velocity of a body.
maxRotationSquared - Static variable in class org.jbox2d.common.Settings
 
maxSubSteps - Static variable in class org.jbox2d.common.Settings
Maximum number of sub-steps per contact in continuous physics simulation.
maxTOIContacts - Static variable in class org.jbox2d.common.Settings
Maximum number of contacts to be handled to solve a TOI island.
maxToOut(Vec2, Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
maxTorque - Variable in class org.jbox2d.dynamics.joints.FrictionJointDef
The maximum friction torque in N-m.
maxTranslation - Static variable in class org.jbox2d.common.Settings
The maximum linear velocity of a body.
maxTranslationSquared - Static variable in class org.jbox2d.common.Settings
 
metric - Variable in class org.jbox2d.collision.Distance.SimplexCache
length or area
min(float, float) - Static method in class org.jbox2d.common.MathUtils
 
min(int, int) - Static method in class org.jbox2d.common.MathUtils
 
min(Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
MIN_PULLEY_LENGTH - Static variable in class org.jbox2d.dynamics.joints.PulleyJoint
 
minToOut(Vec2, Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
mixFriction(float, float) - Static method in class org.jbox2d.common.Settings
Friction mixing law.
mixFriction(float, float) - Static method in class org.jbox2d.dynamics.contacts.Contact
Friction mixing law.
mixRestitution(float, float) - Static method in class org.jbox2d.common.Settings
Restitution mixing law.
mixRestitution(float, float) - Static method in class org.jbox2d.dynamics.contacts.Contact
Restitution mixing law.
motorSpeed - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
The desired motor speed in radians per second.
motorSpeed - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
The desired motor speed.
motorSpeed - Variable in class org.jbox2d.dynamics.joints.WheelJointDef
The desired motor speed in radians per second.
MouseJoint - Class in org.jbox2d.dynamics.joints
A mouse joint is used to make a point on a body track a specified world point.
MouseJoint(IWorldPool, MouseJointDef) - Constructor for class org.jbox2d.dynamics.joints.MouseJoint
 
MouseJointDef - Class in org.jbox2d.dynamics.joints
Mouse joint definition.
MouseJointDef() - Constructor for class org.jbox2d.dynamics.joints.MouseJointDef
 
moveProxy(int, AABB, Vec2) - Method in class org.jbox2d.collision.broadphase.BroadPhase
Call MoveProxy as many times as you like, then when you are done call UpdatePairs to finalized the proxy pairs (for your time step).
moveProxy(int, AABB, Vec2) - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Move a proxy with a swepted AABB.
moveProxy(int, AABB, Vec2) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
mul(Vec2) - Method in class org.jbox2d.common.Mat22
Multiply a vector by this matrix.
mul(Mat22) - Method in class org.jbox2d.common.Mat22
Multiply another matrix by this one (this one on left).
mul(Mat22, Vec2) - Static method in class org.jbox2d.common.Mat22
 
mul(Mat22, Mat22) - Static method in class org.jbox2d.common.Mat22
 
mul(Mat33, Vec3) - Static method in class org.jbox2d.common.Mat33
 
mul(Rot, Rot, Rot) - Static method in class org.jbox2d.common.Rot
 
mul(Transform, Vec2) - Static method in class org.jbox2d.common.Transform
 
mul(Transform, Transform) - Static method in class org.jbox2d.common.Transform
 
mul(float) - Method in class org.jbox2d.common.Vec2
Return this vector multiplied by a scalar; does not alter this vector.
mul(float) - Method in class org.jbox2d.common.Vec3
 
mul22(Mat33, Vec2) - Static method in class org.jbox2d.common.Mat33
 
mul22ToOut(Mat33, Vec2, Vec2) - Static method in class org.jbox2d.common.Mat33
 
mul22ToOutUnsafe(Mat33, Vec2, Vec2) - Static method in class org.jbox2d.common.Mat33
 
mulByTransform(Mat22) - Method in class org.jbox2d.common.OBBViewportTransform
Multiplies the obb transform by the given transform
mulLocal(Mat22) - Method in class org.jbox2d.common.Mat22
 
mulLocal(float) - Method in class org.jbox2d.common.Vec2
Multiply this vector by a number and return result - alters this vector.
mulLocal(float) - Method in class org.jbox2d.common.Vec3
 
mulToOut(Vec2, Vec2) - Method in class org.jbox2d.common.Mat22
 
mulToOut(Mat22, Mat22) - Method in class org.jbox2d.common.Mat22
 
mulToOut(Mat22, Vec2, Vec2) - Static method in class org.jbox2d.common.Mat22
 
mulToOut(Mat22, Mat22, Mat22) - Static method in class org.jbox2d.common.Mat22
 
mulToOut(Mat33, Vec3, Vec3) - Static method in class org.jbox2d.common.Mat33
 
mulToOut(Rot, Vec2, Vec2) - Static method in class org.jbox2d.common.Rot
 
mulToOut(Transform, Vec2, Vec2) - Static method in class org.jbox2d.common.Transform
 
mulToOut(Transform, Transform, Transform) - Static method in class org.jbox2d.common.Transform
 
mulToOutUnsafe(Vec2, Vec2) - Method in class org.jbox2d.common.Mat22
 
mulToOutUnsafe(Mat22, Mat22) - Method in class org.jbox2d.common.Mat22
 
mulToOutUnsafe(Mat22, Vec2, Vec2) - Static method in class org.jbox2d.common.Mat22
 
mulToOutUnsafe(Mat22, Mat22, Mat22) - Static method in class org.jbox2d.common.Mat22
 
mulToOutUnsafe(Mat33, Vec3, Vec3) - Static method in class org.jbox2d.common.Mat33
 
mulToOutUnsafe(Rot, Vec2, Vec2) - Static method in class org.jbox2d.common.Rot
 
mulToOutUnsafe(Transform, Vec2, Vec2) - Static method in class org.jbox2d.common.Transform
 
mulToOutUnsafe(Transform, Transform, Transform) - Static method in class org.jbox2d.common.Transform
 
mulTrans(Mat22) - Method in class org.jbox2d.common.Mat22
Multiply another matrix by the transpose of this one (transpose of this one on left).
mulTrans(Vec2) - Method in class org.jbox2d.common.Mat22
Multiply a vector by the transpose of this matrix.
mulTrans(Mat22, Vec2) - Static method in class org.jbox2d.common.Mat22
 
mulTrans(Mat22, Mat22) - Static method in class org.jbox2d.common.Mat22
 
mulTrans(Rot, Rot, Rot) - Static method in class org.jbox2d.common.Rot
 
mulTrans(Rot, Vec2, Vec2) - Static method in class org.jbox2d.common.Rot
 
mulTrans(Transform, Vec2) - Static method in class org.jbox2d.common.Transform
 
mulTrans(Transform, Transform) - Static method in class org.jbox2d.common.Transform
 
mulTransLocal(Mat22) - Method in class org.jbox2d.common.Mat22
 
mulTransToOut(Mat22, Mat22) - Method in class org.jbox2d.common.Mat22
 
mulTransToOut(Vec2, Vec2) - Method in class org.jbox2d.common.Mat22
 
mulTransToOut(Mat22, Vec2, Vec2) - Static method in class org.jbox2d.common.Mat22
 
mulTransToOut(Mat22, Mat22, Mat22) - Static method in class org.jbox2d.common.Mat22
 
mulTransToOut(Transform, Vec2, Vec2) - Static method in class org.jbox2d.common.Transform
 
mulTransToOut(Transform, Transform, Transform) - Static method in class org.jbox2d.common.Transform
 
mulTransToOutUnsafe(Mat22, Mat22) - Method in class org.jbox2d.common.Mat22
 
mulTransToOutUnsafe(Mat22, Vec2, Vec2) - Static method in class org.jbox2d.common.Mat22
 
mulTransToOutUnsafe(Mat22, Mat22, Mat22) - Static method in class org.jbox2d.common.Mat22
 
mulTransToOutUnsafe(Transform, Vec2, Vec2) - Static method in class org.jbox2d.common.Transform
 
mulTransToOutUnsafe(Transform, Transform, Transform) - Static method in class org.jbox2d.common.Transform
 
mulTransUnsafe(Rot, Rot, Rot) - Static method in class org.jbox2d.common.Rot
 
mulTransUnsafe(Rot, Vec2, Vec2) - Static method in class org.jbox2d.common.Rot
 
mulUnsafe(Rot, Rot, Rot) - Static method in class org.jbox2d.common.Rot
 
MutableStack<E> - Class in org.jbox2d.pooling.normal
 
MutableStack(int) - Constructor for class org.jbox2d.pooling.normal.MutableStack
 

N

negate() - Method in class org.jbox2d.common.Vec2
Return the negation of this vector; does not alter this vector.
negate() - Method in class org.jbox2d.common.Vec3
 
negateLocal() - Method in class org.jbox2d.common.Vec2
Flip the vector and return it - alters this vector.
negateLocal() - Method in class org.jbox2d.common.Vec3
 
negateToOut(Vec2, Vec2) - Static method in class org.jbox2d.common.Vec2
 
NEW_FIXTURE - Static variable in class org.jbox2d.dynamics.World
 
newInstance() - Method in class org.jbox2d.pooling.normal.CircleStack
Creates a new instance of the object contained by this stack.
newInstance() - Method in class org.jbox2d.pooling.normal.MutableStack
Creates a new instance of the object contained by this stack.
newInstance() - Method in class org.jbox2d.pooling.normal.OrderedStack
Creates a new instance of the object contained by this stack.
next - Variable in class org.jbox2d.dynamics.contacts.ContactEdge
the next contact edge in the body's contact list
next - Variable in class org.jbox2d.dynamics.joints.JointEdge
the next joint edge in the body's joint list
nextPowerOfTwo(int) - Static method in class org.jbox2d.common.MathUtils
Next Largest Power of 2: Given a binary integer value x, the next largest power of 2 can be computed by a SWAR algorithm that recursively "folds" the upper bits into the lower bits.
normal - Variable in class org.jbox2d.collision.RayCastOutput
 
normal - Variable in class org.jbox2d.collision.WorldManifold
World vector pointing from A to B
normal - Variable in class org.jbox2d.common.RaycastResult
 
normal - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
normalImpulse - Variable in class org.jbox2d.collision.ManifoldPoint
the non-penetration impulse
normalImpulse - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint.VelocityConstraintPoint
 
normalImpulses - Variable in class org.jbox2d.callbacks.ContactImpulse
 
normalize() - Method in class org.jbox2d.common.Sweep
 
normalize() - Method in class org.jbox2d.common.Vec2
Normalize this vector and return the length before normalization.
normalMass - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
normalMass - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint.VelocityConstraintPoint
 
NULL_FEATURE - Static variable in class org.jbox2d.collision.Collision
 
NULL_NODE - Static variable in class org.jbox2d.collision.broadphase.DynamicTree
 
NULL_PROXY - Static variable in class org.jbox2d.collision.broadphase.BroadPhase
 

O

OBB() - Constructor for class org.jbox2d.common.OBBViewportTransform.OBB
 
OBBViewportTransform - Class in org.jbox2d.common
Orientated bounding box viewport transform
OBBViewportTransform() - Constructor for class org.jbox2d.common.OBBViewportTransform
 
OBBViewportTransform.OBB - Class in org.jbox2d.common
 
OrderedStack<E> - Class in org.jbox2d.pooling.normal
 
OrderedStack(int, int) - Constructor for class org.jbox2d.pooling.normal.OrderedStack
 
org.jbox2d.callbacks - package org.jbox2d.callbacks
 
org.jbox2d.collision - package org.jbox2d.collision
 
org.jbox2d.collision.broadphase - package org.jbox2d.collision.broadphase
 
org.jbox2d.collision.shapes - package org.jbox2d.collision.shapes
 
org.jbox2d.common - package org.jbox2d.common
 
org.jbox2d.dynamics - package org.jbox2d.dynamics
 
org.jbox2d.dynamics.contacts - package org.jbox2d.dynamics.contacts
 
org.jbox2d.dynamics.joints - package org.jbox2d.dynamics.joints
 
org.jbox2d.pooling - package org.jbox2d.pooling
 
org.jbox2d.pooling.arrays - package org.jbox2d.pooling.arrays
 
org.jbox2d.pooling.normal - package org.jbox2d.pooling.normal
 
org.jbox2d.pooling.stacks - package org.jbox2d.pooling.stacks
 
org.jbox2d.profile - package org.jbox2d.profile
 
other - Variable in class org.jbox2d.dynamics.contacts.ContactEdge
provides quick access to the other body attached.
other - Variable in class org.jbox2d.dynamics.joints.JointEdge
Provides quick access to the other body attached

P

p - Variable in class org.jbox2d.common.Transform
The translation caused by the transform
p1 - Variable in class org.jbox2d.collision.RayCastInput
 
p2 - Variable in class org.jbox2d.collision.RayCastInput
 
Pair - Class in org.jbox2d.collision.broadphase
Java note: at the "creation" of each node, a random key is given to that node, and that's what we sort from.
Pair() - Constructor for class org.jbox2d.collision.broadphase.Pair
 
PairCallback - Interface in org.jbox2d.callbacks
 
parent - Variable in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
PI - Static variable in class org.jbox2d.common.MathUtils
 
PI - Static variable in class org.jbox2d.common.Settings
Pi.
PistonBenchmark - Class in org.jbox2d.profile
Benchmark - piston example (constantly bumping a bunch of circles and boxes).
PistonBenchmark() - Constructor for class org.jbox2d.profile.PistonBenchmark
 
pointA - Variable in class org.jbox2d.collision.DistanceOutput
Closest point on shapeA
pointB - Variable in class org.jbox2d.collision.DistanceOutput
Closest point on shapeB
pointCount - Variable in class org.jbox2d.collision.Manifold
The number of manifold points.
pointCount - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
points - Variable in class org.jbox2d.collision.Manifold
The points of contact.
points - Variable in class org.jbox2d.collision.WorldManifold
World contact point (point of intersection)
points - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
PolygonAndCircleContact - Class in org.jbox2d.dynamics.contacts
 
PolygonAndCircleContact(IWorldPool) - Constructor for class org.jbox2d.dynamics.contacts.PolygonAndCircleContact
 
PolygonContact - Class in org.jbox2d.dynamics.contacts
 
PolygonContact(IWorldPool) - Constructor for class org.jbox2d.dynamics.contacts.PolygonContact
 
polygonRadius - Static variable in class org.jbox2d.common.Settings
The radius of the polygon/edge shape skin.
PolygonShape - Class in org.jbox2d.collision.shapes
A convex polygon shape.
PolygonShape() - Constructor for class org.jbox2d.collision.shapes.PolygonShape
 
pool - Variable in class org.jbox2d.dynamics.contacts.Contact
 
pool - Variable in class org.jbox2d.dynamics.joints.Joint
 
pop() - Method in class org.jbox2d.collision.broadphase.DynamicTree.TreeNodeStack
 
pop() - Method in interface org.jbox2d.pooling.IDynamicStack
Pops an item off the stack
pop() - Method in interface org.jbox2d.pooling.IOrderedStack
Returns the next object in the pool
pop(int) - Method in interface org.jbox2d.pooling.IOrderedStack
Returns the next 'argNum' objects in the pool in an array
pop() - Method in class org.jbox2d.pooling.normal.CircleStack
 
pop(int) - Method in class org.jbox2d.pooling.normal.CircleStack
 
pop() - Method in class org.jbox2d.pooling.normal.MutableStack
 
pop() - Method in class org.jbox2d.pooling.normal.OrderedStack
 
pop(int) - Method in class org.jbox2d.pooling.normal.OrderedStack
 
pop() - Method in class org.jbox2d.pooling.stacks.DynamicIntStack
 
popAABB() - Method in interface org.jbox2d.pooling.IWorldPool
 
popAABB(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
popAABB() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popAABB(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popContact(Fixture, int, Fixture, int) - Method in class org.jbox2d.dynamics.World
 
popMat22() - Method in interface org.jbox2d.pooling.IWorldPool
 
popMat22(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
popMat22() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popMat22(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popMat33() - Method in interface org.jbox2d.pooling.IWorldPool
 
popMat33() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popRot() - Method in interface org.jbox2d.pooling.IWorldPool
 
popRot() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popVec2() - Method in interface org.jbox2d.pooling.IWorldPool
 
popVec2(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
popVec2() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popVec2(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popVec3() - Method in interface org.jbox2d.pooling.IWorldPool
 
popVec3(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
popVec3() - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
popVec3(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
posIters - Static variable in class org.jbox2d.profile.PistonBenchmark
 
position - Variable in class org.jbox2d.dynamics.BodyDef
The world position of the body.
Position - Class in org.jbox2d.dynamics.contacts
 
Position() - Constructor for class org.jbox2d.dynamics.contacts.Position
 
positionIterations - Variable in class org.jbox2d.dynamics.TimeStep
 
positions - Variable in class org.jbox2d.dynamics.contacts.ContactSolver.ContactSolverDef
 
positions - Variable in class org.jbox2d.dynamics.SolverData
 
postSolve(Contact, ContactImpulse) - Method in interface org.jbox2d.callbacks.ContactListener
This lets you inspect a contact after the solver is finished.
preSolve(Contact, Manifold) - Method in interface org.jbox2d.callbacks.ContactListener
This is called after a contact is updated.
prev - Variable in class org.jbox2d.dynamics.contacts.ContactEdge
the previous contact edge in the body's contact list
prev - Variable in class org.jbox2d.dynamics.joints.JointEdge
the previous joint edge in the body's joint list
primary - Variable in class org.jbox2d.dynamics.contacts.ContactRegister
 
printf(String, Object...) - Method in class org.jbox2d.profile.BasicPerformanceTest
 
println(String) - Method in class org.jbox2d.profile.BasicPerformanceTest
 
printResults() - Method in class org.jbox2d.profile.BasicPerformanceTest
 
PrismaticJoint - Class in org.jbox2d.dynamics.joints
A prismatic joint.
PrismaticJoint(IWorldPool, PrismaticJointDef) - Constructor for class org.jbox2d.dynamics.joints.PrismaticJoint
 
PrismaticJointDef - Class in org.jbox2d.dynamics.joints
Prismatic joint definition.
PrismaticJointDef() - Constructor for class org.jbox2d.dynamics.joints.PrismaticJointDef
 
Profile - Class in org.jbox2d.dynamics
 
Profile() - Constructor for class org.jbox2d.dynamics.Profile
 
proxyA - Variable in class org.jbox2d.collision.DistanceInput
 
proxyA - Variable in class org.jbox2d.collision.TimeOfImpact.TOIInput
 
proxyB - Variable in class org.jbox2d.collision.DistanceInput
 
proxyB - Variable in class org.jbox2d.collision.TimeOfImpact.TOIInput
 
proxyIdA - Variable in class org.jbox2d.collision.broadphase.Pair
 
proxyIdB - Variable in class org.jbox2d.collision.broadphase.Pair
 
PulleyJoint - Class in org.jbox2d.dynamics.joints
The pulley joint is connected to two bodies and two fixed ground points.
PulleyJoint(IWorldPool, PulleyJointDef) - Constructor for class org.jbox2d.dynamics.joints.PulleyJoint
 
PulleyJointDef - Class in org.jbox2d.dynamics.joints
Pulley joint definition.
PulleyJointDef() - Constructor for class org.jbox2d.dynamics.joints.PulleyJointDef
 
push(DynamicTreeNode) - Method in class org.jbox2d.collision.broadphase.DynamicTree.TreeNodeStack
 
push(E) - Method in interface org.jbox2d.pooling.IDynamicStack
Pushes an item back on the stack
push(int) - Method in interface org.jbox2d.pooling.IOrderedStack
Tells the stack to take back the last 'argNum' items
push(int) - Method in class org.jbox2d.pooling.normal.CircleStack
 
push(E) - Method in class org.jbox2d.pooling.normal.MutableStack
 
push(int) - Method in class org.jbox2d.pooling.normal.OrderedStack
 
push(int) - Method in class org.jbox2d.pooling.stacks.DynamicIntStack
 
pushAABB(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
pushAABB(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
pushContact(Contact) - Method in class org.jbox2d.dynamics.World
 
pushMat22(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
pushMat22(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
pushMat33(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
pushMat33(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
pushRot(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
pushRot(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
pushVec2(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
pushVec2(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 
pushVec3(int) - Method in interface org.jbox2d.pooling.IWorldPool
 
pushVec3(int) - Method in class org.jbox2d.pooling.normal.DefaultWorldPool
 

Q

q - Variable in class org.jbox2d.common.Transform
A matrix representing a rotation
QUARTER_PI - Static variable in class org.jbox2d.common.MathUtils
 
query(TreeCallback, AABB) - Method in class org.jbox2d.collision.broadphase.BroadPhase
Query an AABB for overlapping proxies.
query(TreeCallback, AABB) - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Query an AABB for overlapping proxies.
query(TreeCallback, AABB) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
queryAABB(QueryCallback, AABB) - Method in class org.jbox2d.dynamics.World
Query the world for all fixtures that potentially overlap the provided AABB.
QueryCallback - Interface in org.jbox2d.callbacks
Callback class for AABB queries.

R

R - Variable in class org.jbox2d.common.OBBViewportTransform.OBB
 
rA - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint.VelocityConstraintPoint
 
RAD2DEG - Static variable in class org.jbox2d.common.MathUtils
Radians to degrees conversion factor
randomFloat(float, float) - Static method in class org.jbox2d.common.MathUtils
 
randomFloat(Random, float, float) - Static method in class org.jbox2d.common.MathUtils
 
ratio - Variable in class org.jbox2d.dynamics.joints.GearJointDef
Gear ratio.
ratio - Variable in class org.jbox2d.dynamics.joints.PulleyJointDef
The pulley ratio, used to simulate a block-and-tackle.
raycast(RayCastOutput, RayCastInput) - Method in class org.jbox2d.collision.AABB
Deprecated.
raycast(RayCastOutput, RayCastInput, IWorldPool) - Method in class org.jbox2d.collision.AABB
From Real-time Collision Detection, p179.
raycast(TreeRayCastCallback, RayCastInput) - Method in class org.jbox2d.collision.broadphase.BroadPhase
Ray-cast against the proxies in the tree.
raycast(TreeRayCastCallback, RayCastInput) - Method in interface org.jbox2d.collision.broadphase.BroadPhaseStrategy
Ray-cast against the proxies in the tree.
raycast(TreeRayCastCallback, RayCastInput) - Method in class org.jbox2d.collision.broadphase.DynamicTree
 
raycast(RayCastOutput, RayCastInput, Transform, int) - Method in class org.jbox2d.collision.shapes.ChainShape
 
raycast(RayCastOutput, RayCastInput, Transform, int) - Method in class org.jbox2d.collision.shapes.CircleShape
 
raycast(RayCastOutput, RayCastInput, Transform, int) - Method in class org.jbox2d.collision.shapes.EdgeShape
 
raycast(RayCastOutput, RayCastInput, Transform, int) - Method in class org.jbox2d.collision.shapes.PolygonShape
 
raycast(RayCastOutput, RayCastInput, Transform, int) - Method in class org.jbox2d.collision.shapes.Shape
Cast a ray against a child shape.
raycast(RayCastOutput, RayCastInput, int) - Method in class org.jbox2d.dynamics.Fixture
Cast a ray against this shape.
raycast(RayCastCallback, Vec2, Vec2) - Method in class org.jbox2d.dynamics.World
Ray-cast the world for all fixtures in the path of the ray.
RayCastCallback - Interface in org.jbox2d.callbacks
Callback class for ray casts.
raycastCallback(RayCastInput, int) - Method in interface org.jbox2d.callbacks.TreeRayCastCallback
 
RayCastInput - Class in org.jbox2d.collision
Ray-cast input data.
RayCastInput() - Constructor for class org.jbox2d.collision.RayCastInput
 
RayCastOutput - Class in org.jbox2d.collision
Ray-cast output data.
RayCastOutput() - Constructor for class org.jbox2d.collision.RayCastOutput
 
RaycastResult - Class in org.jbox2d.common
 
RaycastResult() - Constructor for class org.jbox2d.common.RaycastResult
 
rB - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint.VelocityConstraintPoint
 
rebuildBottomUp() - Method in class org.jbox2d.collision.broadphase.DynamicTree
Build an optimal tree.
RED - Static variable in class org.jbox2d.common.Color3f
 
reduceAngle(float) - Static method in class org.jbox2d.common.MathUtils
 
referenceAngle - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
The constrained angle between the bodies: body2_angle - body1_angle.
referenceAngle - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
The body2 angle minus body1 angle in the reference state (radians).
referenceAngle - Variable in class org.jbox2d.dynamics.joints.WeldJointDef
The body2 angle minus body1 angle in the reference state (radians).
refilter() - Method in class org.jbox2d.dynamics.Fixture
Call this if you want to establish collision that was previously disabled by ContactFilter::ShouldCollide.
report(ContactVelocityConstraint[]) - Method in class org.jbox2d.dynamics.Island
 
reportFixture(Fixture) - Method in interface org.jbox2d.callbacks.QueryCallback
Called for each fixture found in the query AABB.
reportFixture(Fixture, Vec2, Vec2, float) - Method in interface org.jbox2d.callbacks.RayCastCallback
Called for each fixture found in the query.
reset() - Method in class org.jbox2d.collision.broadphase.DynamicTree.TreeNodeStack
 
reset() - Method in class org.jbox2d.common.Timer
 
reset() - Method in class org.jbox2d.pooling.stacks.DynamicIntStack
 
resetFriction() - Method in class org.jbox2d.dynamics.contacts.Contact
 
resetMassData() - Method in class org.jbox2d.dynamics.Body
This resets the mass properties to the sum of the mass properties of the fixtures.
resetRestitution() - Method in class org.jbox2d.dynamics.contacts.Contact
 
restitution - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
restitution - Variable in class org.jbox2d.dynamics.FixtureDef
The restitution (elasticity) usually in the range [0,1].
RevoluteJoint - Class in org.jbox2d.dynamics.joints
A revolute joint constrains two bodies to share a common point while they are free to rotate about the point.
RevoluteJoint(IWorldPool, RevoluteJointDef) - Constructor for class org.jbox2d.dynamics.joints.RevoluteJoint
 
RevoluteJointDef - Class in org.jbox2d.dynamics.joints
Revolute joint definition.
RevoluteJointDef() - Constructor for class org.jbox2d.dynamics.joints.RevoluteJointDef
 
RopeJoint - Class in org.jbox2d.dynamics.joints
A rope joint enforces a maximum distance between two points on two bodies.
RopeJoint(IWorldPool, RopeJointDef) - Constructor for class org.jbox2d.dynamics.joints.RopeJoint
 
RopeJointDef - Class in org.jbox2d.dynamics.joints
Rope joint definition.
RopeJointDef() - Constructor for class org.jbox2d.dynamics.joints.RopeJointDef
 
Rot - Class in org.jbox2d.common
Represents a rotation
Rot() - Constructor for class org.jbox2d.common.Rot
 
Rot(float) - Constructor for class org.jbox2d.common.Rot
 
round(float) - Static method in class org.jbox2d.common.MathUtils
 
runBenchmarkWorld() - Method in class org.jbox2d.profile.PistonBenchmark
 
runBenchmarkWorld() - Method in class org.jbox2d.profile.SettingsPerformanceTest
 
runTest(int) - Method in class org.jbox2d.profile.BasicPerformanceTest
 
runTest(int) - Method in class org.jbox2d.profile.SettingsPerformanceTest
 

S

s - Variable in class org.jbox2d.common.Rot
 
sayGoodbye(Joint) - Method in interface org.jbox2d.callbacks.DestructionListener
Called when any joint is about to be destroyed due to the destruction of one of its attached bodies.
sayGoodbye(Fixture) - Method in interface org.jbox2d.callbacks.DestructionListener
Called when any fixture is about to be destroyed due to the destruction of its parent body.
set(AABB) - Method in class org.jbox2d.collision.AABB
Sets this object from the given object
set(Collision.ClipVertex) - Method in class org.jbox2d.collision.Collision.ClipVertex
 
set(ContactID) - Method in class org.jbox2d.collision.ContactID
 
set(Shape, int) - Method in class org.jbox2d.collision.Distance.DistanceProxy
Initialize the proxy using the given shape.
set(Distance.SimplexCache) - Method in class org.jbox2d.collision.Distance.SimplexCache
 
set(Manifold) - Method in class org.jbox2d.collision.Manifold
copies this manifold from the given one
set(ManifoldPoint) - Method in class org.jbox2d.collision.ManifoldPoint
Sets this manifold point form the given one
set(RayCastInput) - Method in class org.jbox2d.collision.RayCastInput
 
set(RayCastOutput) - Method in class org.jbox2d.collision.RayCastOutput
 
set(Vec2, Vec2) - Method in class org.jbox2d.collision.shapes.EdgeShape
 
set(MassData) - Method in class org.jbox2d.collision.shapes.MassData
 
set(Vec2[], int) - Method in class org.jbox2d.collision.shapes.PolygonShape
Create a convex hull from the given array of points.
set(Vec2[], int, Vec2Array, IntArray) - Method in class org.jbox2d.collision.shapes.PolygonShape
Create a convex hull from the given array of points.
set(float, float, float) - Method in class org.jbox2d.common.Color3f
 
set(Color3f) - Method in class org.jbox2d.common.Color3f
 
set(Mat22) - Method in class org.jbox2d.common.Mat22
Set as a copy of another matrix.
set(float, float, float, float) - Method in class org.jbox2d.common.Mat22
 
set(float) - Method in class org.jbox2d.common.Mat22
Set as a matrix representing a rotation.
set(Vec2, Vec2) - Method in class org.jbox2d.common.Mat22
Set by column vectors.
set(OBBViewportTransform) - Method in class org.jbox2d.common.OBBViewportTransform
 
set(RaycastResult) - Method in class org.jbox2d.common.RaycastResult
 
set(float) - Method in class org.jbox2d.common.Rot
 
set(Rot) - Method in class org.jbox2d.common.Rot
 
set(Sweep) - Method in class org.jbox2d.common.Sweep
 
set(Transform) - Method in class org.jbox2d.common.Transform
Set this to equal another transform.
set(Vec2, float) - Method in class org.jbox2d.common.Transform
Set this based on the position and angle.
set(float, float) - Method in class org.jbox2d.common.Vec2
Set the vector component-wise.
set(Vec2) - Method in class org.jbox2d.common.Vec2
Set this vector to another vector.
set(Vec3) - Method in class org.jbox2d.common.Vec3
 
set(float, float, float) - Method in class org.jbox2d.common.Vec3
 
set(Filter) - Method in class org.jbox2d.dynamics.Filter
 
setActive(boolean) - Method in class org.jbox2d.dynamics.Body
Set the active state of the body.
setAllowSleep(boolean) - Method in class org.jbox2d.dynamics.World
 
setAngularDamping(float) - Method in class org.jbox2d.dynamics.Body
Set the angular damping of the body.
setAngularVelocity(float) - Method in class org.jbox2d.dynamics.Body
Set the angular velocity.
setAsBox(float, float) - Method in class org.jbox2d.collision.shapes.PolygonShape
Build vertices to represent an axis-aligned box.
setAsBox(float, float, Vec2, float) - Method in class org.jbox2d.collision.shapes.PolygonShape
Build vertices to represent an oriented box.
setAutoClearForces(boolean) - Method in class org.jbox2d.dynamics.World
Set flag to control automatic clearing of forces after each time step.
setAwake(boolean) - Method in class org.jbox2d.dynamics.Body
Set the sleep state of the body.
setBullet(boolean) - Method in class org.jbox2d.dynamics.Body
Should this body be treated like a bullet for continuous collision detection?
setCamera(float, float, float) - Method in class org.jbox2d.callbacks.DebugDraw
 
setCamera(float, float, float) - Method in interface org.jbox2d.common.IViewportTransform
Sets the transform's center to the given x and y coordinates, and using the given scale.
setCamera(float, float, float) - Method in class org.jbox2d.common.OBBViewportTransform
 
setCenter(Vec2) - Method in interface org.jbox2d.common.IViewportTransform
sets the center of the viewport.
setCenter(float, float) - Method in interface org.jbox2d.common.IViewportTransform
sets the center of the viewport.
setCenter(Vec2) - Method in class org.jbox2d.common.OBBViewportTransform
 
setCenter(float, float) - Method in class org.jbox2d.common.OBBViewportTransform
 
setContactFilter(ContactFilter) - Method in class org.jbox2d.dynamics.World
Register a contact filter to provide specific control over collision.
setContactListener(ContactListener) - Method in class org.jbox2d.dynamics.World
Register a contact event listener.
setContinuousPhysics(boolean) - Method in class org.jbox2d.dynamics.World
Enable/disable continuous physics.
setDampingRatio(float) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
setDampingRatio(float) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
setDampingRatio(float) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
setDebugDraw(DebugDraw) - Method in class org.jbox2d.dynamics.World
Register a routine for debug drawing.
setDensity(float) - Method in class org.jbox2d.dynamics.Fixture
 
setDestructionListener(DestructionListener) - Method in class org.jbox2d.dynamics.World
Register a destruction listener.
setEnabled(boolean) - Method in class org.jbox2d.dynamics.contacts.Contact
Enable/disable this contact.
setExtents(Vec2) - Method in interface org.jbox2d.common.IViewportTransform
This sets the half-width and half-height.
setExtents(float, float) - Method in interface org.jbox2d.common.IViewportTransform
This sets the half-width and half-height of the viewport.
setExtents(Vec2) - Method in class org.jbox2d.common.OBBViewportTransform
 
setExtents(float, float) - Method in class org.jbox2d.common.OBBViewportTransform
 
setFilterData(Filter) - Method in class org.jbox2d.dynamics.Fixture
Set the contact filtering data.
setFixedRotation(boolean) - Method in class org.jbox2d.dynamics.Body
Set this body to have fixed rotation.
setFlags(int) - Method in class org.jbox2d.callbacks.DebugDraw
 
setFrequency(float) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
setFrequency(float) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
setFrequency(float) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
setFriction(float) - Method in class org.jbox2d.dynamics.contacts.Contact
 
setFriction(float) - Method in class org.jbox2d.dynamics.Fixture
Set the coefficient of friction.
setGravity(Vec2) - Method in class org.jbox2d.dynamics.World
Change the global gravity vector.
setGravityScale(float) - Method in class org.jbox2d.dynamics.Body
Set the gravity scale of the body.
setIdentity() - Method in class org.jbox2d.common.Mat22
Set as the identity matrix.
setIdentity() - Method in class org.jbox2d.common.Rot
 
setIdentity() - Method in class org.jbox2d.common.Transform
Set this to the identity transform.
setLength(float) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
setLimits(float, float) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Set the joint limits, usually in meters.
setLimits(float, float) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
setLinearDamping(float) - Method in class org.jbox2d.dynamics.Body
Set the linear damping of the body.
setLinearVelocity(Vec2) - Method in class org.jbox2d.dynamics.Body
Set the linear velocity of the center of mass.
setMassData(MassData) - Method in class org.jbox2d.dynamics.Body
Set the mass properties to override the mass properties of the fixtures.
setMaxForce(float) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
setMaxForce(float) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
setMaxLength(float) - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
setMaxMotorForce(float) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Set the maximum motor force, usually in N.
setMaxMotorTorque(float) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
setMaxMotorTorque(float) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
setMaxTorque(float) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
setMotorSpeed(float) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
Set the motor speed, usually in meters per second.
setMotorSpeed(float) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
setMotorSpeed(float) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
setNextVertex(Vec2) - Method in class org.jbox2d.collision.shapes.ChainShape
Establish connectivity to a vertex that follows the last vertex.
setPrevVertex(Vec2) - Method in class org.jbox2d.collision.shapes.ChainShape
Establish connectivity to a vertex that precedes the first vertex.
setRadius(float) - Method in class org.jbox2d.collision.shapes.Shape
Sets the radius of the underlying shape.
setRatio(float) - Method in class org.jbox2d.dynamics.joints.GearJoint
 
setRestitution(float) - Method in class org.jbox2d.dynamics.contacts.Contact
 
setRestitution(float) - Method in class org.jbox2d.dynamics.Fixture
Set the coefficient of restitution.
setSensor(boolean) - Method in class org.jbox2d.dynamics.Fixture
Set if this fixture is a sensor.
setSleepingAllowed(boolean) - Method in class org.jbox2d.dynamics.Body
You can disable sleeping on this body.
setSleepingAllowed(boolean) - Method in class org.jbox2d.dynamics.World
 
setSpringDampingRatio(float) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
setSpringFrequencyHz(float) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
setSubStepping(boolean) - Method in class org.jbox2d.dynamics.World
 
setTangentSpeed(float) - Method in class org.jbox2d.dynamics.contacts.Contact
 
setTarget(Vec2) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
Settings - Class in org.jbox2d.common
Global tuning constants based on MKS units and various integer maximums (vertices per shape, pairs, etc.).
Settings() - Constructor for class org.jbox2d.common.Settings
 
SettingsPerformanceTest - Class in org.jbox2d.profile
 
SettingsPerformanceTest(int) - Constructor for class org.jbox2d.profile.SettingsPerformanceTest
 
setTransform(Mat22) - Method in class org.jbox2d.common.OBBViewportTransform
Sets the transform of the viewport.
setTransform(Vec2, float) - Method in class org.jbox2d.dynamics.Body
Set the position of the body's origin and rotation.
setType(BodyType) - Method in class org.jbox2d.dynamics.Body
Set the type of this body.
setUserData(Object) - Method in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
setUserData(Object) - Method in class org.jbox2d.dynamics.Body
Set the user data.
setUserData(Object) - Method in class org.jbox2d.dynamics.Fixture
Set the user data.
setUserData(Object) - Method in class org.jbox2d.dynamics.joints.Joint
Set the user data pointer.
setWarmStarting(boolean) - Method in class org.jbox2d.dynamics.World
Enable/disable warm starting.
setYFlip(boolean) - Method in interface org.jbox2d.common.IViewportTransform
 
setYFlip(boolean) - Method in class org.jbox2d.common.OBBViewportTransform
 
setZero() - Method in class org.jbox2d.common.Mat22
Set as the zero matrix.
setZero() - Method in class org.jbox2d.common.Mat33
 
setZero() - Method in class org.jbox2d.common.Vec2
Zero out this vector.
setZero() - Method in class org.jbox2d.common.Vec3
 
Shape - Class in org.jbox2d.collision.shapes
A shape is used for collision detection.
Shape(ShapeType) - Constructor for class org.jbox2d.collision.shapes.Shape
 
shape - Variable in class org.jbox2d.dynamics.FixtureDef
The shape, this must be set.
ShapeType - Enum in org.jbox2d.collision.shapes
Types of shapes
shouldCollide(Fixture, Fixture) - Method in class org.jbox2d.callbacks.ContactFilter
Return true if contact calculations should be performed between these two shapes.
shouldCollide(Body) - Method in class org.jbox2d.dynamics.Body
This is used to prevent connected bodies from colliding.
SimplexCache() - Constructor for class org.jbox2d.collision.Distance.SimplexCache
 
sin(float) - Static method in class org.jbox2d.common.MathUtils
 
SINCOS_LUT_ENABLED - Static variable in class org.jbox2d.common.Settings
 
SINCOS_LUT_LENGTH - Static variable in class org.jbox2d.common.Settings
 
SINCOS_LUT_LERP - Static variable in class org.jbox2d.common.Settings
Use if the table's precision is large (eg .006 or greater).
SINCOS_LUT_PRECISION - Static variable in class org.jbox2d.common.Settings
smaller the precision, the larger the table.
sinLUT - Static variable in class org.jbox2d.common.MathUtils
 
sinLUT(float) - Static method in class org.jbox2d.common.MathUtils
 
skew() - Method in class org.jbox2d.common.Vec2
Get the skew vector such that dot(skew_vec, other) == cross(vec, other)
skew(Vec2) - Method in class org.jbox2d.common.Vec2
Get the skew vector such that dot(skew_vec, other) == cross(vec, other)
solve(Vec2) - Method in class org.jbox2d.common.Mat22
Solve A * x = b where A = this matrix.
solve(Profile, TimeStep, Vec2, boolean) - Method in class org.jbox2d.dynamics.Island
 
solve - Variable in class org.jbox2d.dynamics.Profile
 
solve22(Vec2) - Method in class org.jbox2d.common.Mat33
Solve A * x = b, where b is a column vector.
solve22ToOut(Vec2, Vec2) - Method in class org.jbox2d.common.Mat33
Solve A * x = b, where b is a column vector.
solve33(Vec3) - Method in class org.jbox2d.common.Mat33
Solve A * x = b, where b is a column vector.
solve33ToOut(Vec3, Vec3) - Method in class org.jbox2d.common.Mat33
Solve A * x = b, where b is a column vector.
solveInit - Variable in class org.jbox2d.dynamics.Profile
 
solvePosition - Variable in class org.jbox2d.dynamics.Profile
 
solvePositionConstraints() - Method in class org.jbox2d.dynamics.contacts.ContactSolver
Sequential solver.
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.GearJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.Joint
This returns true if the position errors are within tolerance.
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
solvePositionConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
SolverData - Class in org.jbox2d.dynamics
 
SolverData() - Constructor for class org.jbox2d.dynamics.SolverData
 
solveTOI(TimeStep, int, int) - Method in class org.jbox2d.dynamics.Island
 
solveTOI - Variable in class org.jbox2d.dynamics.Profile
 
solveTOIPositionConstraints(int, int) - Method in class org.jbox2d.dynamics.contacts.ContactSolver
 
solveToOut(Vec2, Vec2) - Method in class org.jbox2d.common.Mat22
 
solveVelocity - Variable in class org.jbox2d.dynamics.Profile
 
solveVelocityConstraints() - Method in class org.jbox2d.dynamics.contacts.ContactSolver
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.ConstantVolumeJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.DistanceJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.FrictionJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.GearJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.Joint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.MouseJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.PrismaticJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.PulleyJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.RevoluteJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.RopeJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.WeldJoint
 
solveVelocityConstraints(SolverData) - Method in class org.jbox2d.dynamics.joints.WheelJoint
 
sqrt(float) - Static method in class org.jbox2d.common.MathUtils
 
state - Variable in class org.jbox2d.collision.TimeOfImpact.TOIOutput
 
step - Variable in class org.jbox2d.dynamics.contacts.ContactSolver.ContactSolverDef
 
step - Variable in class org.jbox2d.dynamics.Profile
 
step - Variable in class org.jbox2d.dynamics.SolverData
 
step(float, int, int) - Method in class org.jbox2d.dynamics.World
Take a time step.
storeImpulses() - Method in class org.jbox2d.dynamics.contacts.ContactSolver
 
sub(Vec2) - Method in class org.jbox2d.common.Vec2
Return the difference of this vector and another; does not alter either one.
sub(Vec3) - Method in class org.jbox2d.common.Vec3
 
subLocal(Vec2) - Method in class org.jbox2d.common.Vec2
Subtract another vector from this one and return result - alters this vector.
subLocal(Vec3) - Method in class org.jbox2d.common.Vec3
 
Sweep - Class in org.jbox2d.common
This describes the motion of a body/shape for TOI computation.
Sweep() - Constructor for class org.jbox2d.common.Sweep
 
sweepA - Variable in class org.jbox2d.collision.TimeOfImpact.TOIInput
 
sweepB - Variable in class org.jbox2d.collision.TimeOfImpact.TOIInput
 
synchronize(BroadPhase, Transform, Transform) - Method in class org.jbox2d.dynamics.Fixture
Internal method
synchronizeFixtures() - Method in class org.jbox2d.dynamics.Body
 
synchronizeTransform() - Method in class org.jbox2d.dynamics.Body
 

T

t - Variable in class org.jbox2d.collision.TimeOfImpact.TOIOutput
 
tangentImpulse - Variable in class org.jbox2d.collision.ManifoldPoint
the friction impulse
tangentImpulse - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint.VelocityConstraintPoint
 
tangentImpulses - Variable in class org.jbox2d.callbacks.ContactImpulse
 
tangentMass - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint.VelocityConstraintPoint
 
tangentSpeed - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint
 
target - Variable in class org.jbox2d.dynamics.joints.MouseJointDef
The initial world target point.
testOverlap(AABB, AABB) - Static method in class org.jbox2d.collision.AABB
 
testOverlap(int, int) - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
testOverlap(Shape, int, Shape, int, Transform, Transform) - Method in class org.jbox2d.collision.Collision
Determine if two generic shapes overlap.
testPoint(Transform, Vec2) - Method in class org.jbox2d.collision.shapes.ChainShape
 
testPoint(Transform, Vec2) - Method in class org.jbox2d.collision.shapes.CircleShape
 
testPoint(Transform, Vec2) - Method in class org.jbox2d.collision.shapes.EdgeShape
 
testPoint(Transform, Vec2) - Method in class org.jbox2d.collision.shapes.PolygonShape
 
testPoint(Transform, Vec2) - Method in class org.jbox2d.collision.shapes.Shape
Test a point for containment in this shape.
testPoint(Vec2) - Method in class org.jbox2d.dynamics.Fixture
Test a point for containment in this fixture.
THREE_HALVES_PI - Static variable in class org.jbox2d.common.MathUtils
 
TimeOfImpact - Class in org.jbox2d.collision
Class used for computing the time of impact.
TimeOfImpact(IWorldPool) - Constructor for class org.jbox2d.collision.TimeOfImpact
 
timeOfImpact(TimeOfImpact.TOIOutput, TimeOfImpact.TOIInput) - Method in class org.jbox2d.collision.TimeOfImpact
Compute the upper bound on time before two shapes penetrate.
TimeOfImpact.TOIInput - Class in org.jbox2d.collision
Input parameters for TOI
TimeOfImpact.TOIOutput - Class in org.jbox2d.collision
Output parameters for TimeOfImpact
TimeOfImpact.TOIOutputState - Enum in org.jbox2d.collision
 
Timer - Class in org.jbox2d.common
 
Timer() - Constructor for class org.jbox2d.common.Timer
 
times - Variable in class org.jbox2d.profile.BasicPerformanceTest
 
TimeStep - Class in org.jbox2d.dynamics
This is an internal structure.
TimeStep() - Constructor for class org.jbox2d.dynamics.TimeStep
 
timeStep - Static variable in class org.jbox2d.profile.PistonBenchmark
 
timeToSleep - Static variable in class org.jbox2d.common.Settings
The time that a body must be still before it will go to sleep.
tMax - Variable in class org.jbox2d.collision.TimeOfImpact.TOIInput
defines sweep interval [0, tMax]
toDebugStrings(List<String>) - Method in class org.jbox2d.dynamics.Profile
 
TOI_FLAG - Static variable in class org.jbox2d.dynamics.contacts.Contact
 
toiBaugarte - Static variable in class org.jbox2d.common.Settings
 
toiCalls - Static variable in class org.jbox2d.collision.TimeOfImpact
 
TOIInput() - Constructor for class org.jbox2d.collision.TimeOfImpact.TOIInput
 
toiIters - Static variable in class org.jbox2d.collision.TimeOfImpact
 
toiMaxIters - Static variable in class org.jbox2d.collision.TimeOfImpact
 
toiMaxRootIters - Static variable in class org.jbox2d.collision.TimeOfImpact
 
TOIOutput() - Constructor for class org.jbox2d.collision.TimeOfImpact.TOIOutput
 
toiRootIters - Static variable in class org.jbox2d.collision.TimeOfImpact
 
toString() - Method in class org.jbox2d.collision.AABB
 
toString() - Method in class org.jbox2d.common.Mat22
Convert the matrix to printable format.
toString() - Method in class org.jbox2d.common.Rot
 
toString() - Method in class org.jbox2d.common.Sweep
 
toString() - Method in class org.jbox2d.common.Transform
 
toString() - Method in class org.jbox2d.common.Vec2
 
toString() - Method in class org.jbox2d.common.Vec3
 
TOUCHING_FLAG - Static variable in class org.jbox2d.dynamics.contacts.Contact
 
touchProxy(int) - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
Transform - Class in org.jbox2d.common
A transform contains translation and rotation.
Transform() - Constructor for class org.jbox2d.common.Transform
The default constructor.
Transform(Transform) - Constructor for class org.jbox2d.common.Transform
Initialize as a copy of another transform.
Transform(Vec2, Rot) - Constructor for class org.jbox2d.common.Transform
Initialize using a position vector and a rotation matrix.
transformA - Variable in class org.jbox2d.collision.DistanceInput
 
transformB - Variable in class org.jbox2d.collision.DistanceInput
 
TreeCallback - Interface in org.jbox2d.callbacks
callback for DynamicTree
treeCallback(int) - Method in interface org.jbox2d.callbacks.TreeCallback
Callback from a query request.
treeCallback(int) - Method in class org.jbox2d.collision.broadphase.BroadPhase
This is called from DynamicTree::query when we are gathering pairs.
TreeNodeStack(int) - Constructor for class org.jbox2d.collision.broadphase.DynamicTree.TreeNodeStack
 
TreeRayCastCallback - Interface in org.jbox2d.callbacks
callback for DynamicTree
TWOPI - Static variable in class org.jbox2d.common.MathUtils
 
type - Variable in class org.jbox2d.collision.Manifold
 
type - Variable in class org.jbox2d.dynamics.BodyDef
The body type: static, kinematic, or dynamic.
type - Variable in class org.jbox2d.dynamics.joints.JointDef
The joint type is set automatically for concrete joint types.
typeA - Variable in class org.jbox2d.collision.ContactID
 
typeB - Variable in class org.jbox2d.collision.ContactID
 

U

unbufferMove(int) - Method in class org.jbox2d.collision.broadphase.BroadPhase
 
update(ContactListener) - Method in class org.jbox2d.dynamics.contacts.Contact
 
updatePairs(PairCallback) - Method in class org.jbox2d.collision.broadphase.BroadPhase
Update the pairs.
upperAngle - Variable in class org.jbox2d.dynamics.joints.RevoluteJointDef
The upper angle for the joint limit (radians).
upperBound - Variable in class org.jbox2d.collision.AABB
Top right vertex of bounding box.
upperTranslation - Variable in class org.jbox2d.dynamics.joints.PrismaticJointDef
The upper translation limit, usually in meters.
useRadii - Variable in class org.jbox2d.collision.DistanceInput
 
userData - Variable in class org.jbox2d.collision.broadphase.DynamicTreeNode
 
userData - Variable in class org.jbox2d.dynamics.BodyDef
Use this to store application specific body data.
userData - Variable in class org.jbox2d.dynamics.FixtureDef
Use this to store application specific fixture data.
userData - Variable in class org.jbox2d.dynamics.joints.JointDef
Use this to attach application specific data to your joints.

V

v - Variable in class org.jbox2d.collision.Collision.ClipVertex
 
v - Variable in class org.jbox2d.dynamics.contacts.Velocity
 
validate() - Method in class org.jbox2d.collision.broadphase.DynamicTree
Validate this tree.
validate() - Method in class org.jbox2d.collision.shapes.PolygonShape
Validate convexity.
valueOf(String) - Static method in enum org.jbox2d.collision.Collision.PointState
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum org.jbox2d.collision.ContactID.Type
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum org.jbox2d.collision.Manifold.ManifoldType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum org.jbox2d.collision.shapes.ShapeType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum org.jbox2d.collision.TimeOfImpact.TOIOutputState
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum org.jbox2d.dynamics.BodyType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum org.jbox2d.dynamics.joints.JointType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum org.jbox2d.dynamics.joints.LimitState
Returns the enum constant of this type with the specified name.
values() - Static method in enum org.jbox2d.collision.Collision.PointState
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum org.jbox2d.collision.ContactID.Type
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum org.jbox2d.collision.Manifold.ManifoldType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum org.jbox2d.collision.shapes.ShapeType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum org.jbox2d.collision.TimeOfImpact.TOIOutputState
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum org.jbox2d.dynamics.BodyType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum org.jbox2d.dynamics.joints.JointType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum org.jbox2d.dynamics.joints.LimitState
Returns an array containing the constants of this enum type, in the order they are declared.
Vec2 - Class in org.jbox2d.common
A 2D column vector
Vec2() - Constructor for class org.jbox2d.common.Vec2
 
Vec2(float, float) - Constructor for class org.jbox2d.common.Vec2
 
Vec2(Vec2) - Constructor for class org.jbox2d.common.Vec2
 
Vec2Array - Class in org.jbox2d.pooling.arrays
not thread safe Vec2[] pool
Vec2Array() - Constructor for class org.jbox2d.pooling.arrays.Vec2Array
 
Vec3 - Class in org.jbox2d.common
 
Vec3() - Constructor for class org.jbox2d.common.Vec3
 
Vec3(float, float, float) - Constructor for class org.jbox2d.common.Vec3
 
Vec3(Vec3) - Constructor for class org.jbox2d.common.Vec3
 
velIters - Static variable in class org.jbox2d.profile.PistonBenchmark
 
velocities - Variable in class org.jbox2d.dynamics.contacts.ContactSolver.ContactSolverDef
 
velocities - Variable in class org.jbox2d.dynamics.SolverData
 
Velocity - Class in org.jbox2d.dynamics.contacts
 
Velocity() - Constructor for class org.jbox2d.dynamics.contacts.Velocity
 
velocityBias - Variable in class org.jbox2d.dynamics.contacts.ContactVelocityConstraint.VelocityConstraintPoint
 
VelocityConstraintPoint() - Constructor for class org.jbox2d.dynamics.contacts.ContactVelocityConstraint.VelocityConstraintPoint
 
velocityIterations - Variable in class org.jbox2d.dynamics.TimeStep
 
velocityThreshold - Static variable in class org.jbox2d.common.Settings
A velocity threshold for elastic collisions.
viewportTransform - Variable in class org.jbox2d.callbacks.DebugDraw
 

W

w - Variable in class org.jbox2d.dynamics.contacts.Velocity
 
warmStart() - Method in class org.jbox2d.dynamics.contacts.ContactSolver
 
warmStarting - Variable in class org.jbox2d.dynamics.TimeStep
 
WeldJoint - Class in org.jbox2d.dynamics.joints
A weld joint essentially glues two bodies together.
WeldJoint(IWorldPool, WeldJointDef) - Constructor for class org.jbox2d.dynamics.joints.WeldJoint
 
WeldJointDef - Class in org.jbox2d.dynamics.joints
 
WeldJointDef() - Constructor for class org.jbox2d.dynamics.joints.WeldJointDef
 
WheelJoint - Class in org.jbox2d.dynamics.joints
A wheel joint.
WheelJoint(IWorldPool, WheelJointDef) - Constructor for class org.jbox2d.dynamics.joints.WheelJoint
 
WheelJointDef - Class in org.jbox2d.dynamics.joints
Wheel joint definition.
WheelJointDef() - Constructor for class org.jbox2d.dynamics.joints.WheelJointDef
 
WHITE - Static variable in class org.jbox2d.common.Color3f
 
World - Class in org.jbox2d.dynamics
The world class manages all physics entities, dynamic simulation, and asynchronous queries.
World(Vec2) - Constructor for class org.jbox2d.dynamics.World
Construct a world object.
World(Vec2, IWorldPool) - Constructor for class org.jbox2d.dynamics.World
Construct a world object.
World(Vec2, IWorldPool, BroadPhaseStrategy) - Constructor for class org.jbox2d.dynamics.World
 
world - Variable in class org.jbox2d.profile.PistonBenchmark
 
WORLD_POOL_CONTAINER_SIZE - Static variable in class org.jbox2d.dynamics.World
 
WORLD_POOL_SIZE - Static variable in class org.jbox2d.dynamics.World
 
WorldManifold - Class in org.jbox2d.collision
This is used to compute the current state of a contact manifold.
WorldManifold() - Constructor for class org.jbox2d.collision.WorldManifold
 

X

x - Variable in class org.jbox2d.common.Color3f
 
x - Variable in class org.jbox2d.common.Vec2
 
x - Variable in class org.jbox2d.common.Vec3
 

Y

y - Variable in class org.jbox2d.common.Color3f
 
y - Variable in class org.jbox2d.common.Vec2
 
y - Variable in class org.jbox2d.common.Vec3
 

Z

z - Variable in class org.jbox2d.common.Color3f
 
z - Variable in class org.jbox2d.common.Vec3
 
zero() - Method in class org.jbox2d.collision.ContactID
zeros out the data
A B C D E F G H I J K L M N O P Q R S T U V W X Y Z 
Skip navigation links

Copyright © 2017. All Rights Reserved.