A B C D E F G H I J L M N O P Q R S T U V W 

A

AABB_COLOR - Variable in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
active - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
Does this body start out active?
allowSleep - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
Set this flag to false if this body should never fall asleep.
angle - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
The world angle of the body in radians.
angularDamping - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
Angular damping is use to reduce the angular velocity.
angularOffset - Variable in class com.badlogic.gdx.physics.box2d.joints.MotorJointDef
The bodyB angle minus bodyA angle in radians.
angularVelocity - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
The angular velocity of the body.
applyAngularImpulse(float, boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Apply an angular impulse.
applyForce(Vector2, Vector2, boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Apply a force at a world point.
applyForce(float, float, float, float, boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Apply a force at a world point.
applyForceToCenter(Vector2, boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Apply a force to the center of mass.
applyForceToCenter(float, float, boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Apply a force to the center of mass.
applyLinearImpulse(Vector2, Vector2, boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Apply an impulse at a point.
applyLinearImpulse(float, float, float, float, boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Apply an impulse at a point.
applyTorque(float, boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Apply a torque.
awake - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
Is this body initially awake or sleeping?

B

beginContact(Contact) - Method in interface com.badlogic.gdx.physics.box2d.ContactListener
Called when two fixtures begin to touch.
Body - Class in com.badlogic.gdx.physics.box2d
A rigid body.
bodyA - Variable in class com.badlogic.gdx.physics.box2d.JointDef
The first attached body.
bodyB - Variable in class com.badlogic.gdx.physics.box2d.JointDef
The second attached body
BodyDef - Class in com.badlogic.gdx.physics.box2d
A body definition holds all the data needed to construct a rigid body.
BodyDef() - Constructor for class com.badlogic.gdx.physics.box2d.BodyDef
 
BodyDef.BodyType - Enum in com.badlogic.gdx.physics.box2d
The body type.
Box2DBuild - Class in com.badlogic.gdx.physics.box2d.utils
 
Box2DBuild() - Constructor for class com.badlogic.gdx.physics.box2d.utils.Box2DBuild
 
Box2DDebugRenderer - Class in com.badlogic.gdx.physics.box2d
 
Box2DDebugRenderer() - Constructor for class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
Box2DDebugRenderer(boolean, boolean, boolean, boolean, boolean, boolean) - Constructor for class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
bullet - Variable in class com.badlogic.gdx.physics.box2d.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.

C

categoryBits - Variable in class com.badlogic.gdx.physics.box2d.Filter
The collision category bits.
center - Variable in class com.badlogic.gdx.physics.box2d.MassData
The position of the shape's centroid relative to the shape's origin.
ChainShape - Class in com.badlogic.gdx.physics.box2d
 
ChainShape() - Constructor for class com.badlogic.gdx.physics.box2d.ChainShape
 
CircleShape - Class in com.badlogic.gdx.physics.box2d
A circle shape.
CircleShape() - Constructor for class com.badlogic.gdx.physics.box2d.CircleShape
 
clearForces() - Method in class com.badlogic.gdx.physics.box2d.World
Manually clear the force buffer on all bodies.
collideConnected - Variable in class com.badlogic.gdx.physics.box2d.JointDef
Set this flag to true if the attached bodies should collide.
com.badlogic.gdx.physics.box2d - package com.badlogic.gdx.physics.box2d
 
com.badlogic.gdx.physics.box2d.graphics - package com.badlogic.gdx.physics.box2d.graphics
 
com.badlogic.gdx.physics.box2d.joints - package com.badlogic.gdx.physics.box2d.joints
 
com.badlogic.gdx.physics.box2d.utils - package com.badlogic.gdx.physics.box2d.utils
 
Contact - Class in com.badlogic.gdx.physics.box2d
The class manages contact between two shapes.
ContactFilter - Interface in com.badlogic.gdx.physics.box2d
Implement this class to provide collision filtering.
contactID - Variable in class com.badlogic.gdx.physics.box2d.Manifold.ManifoldPoint
 
ContactImpulse - Class in com.badlogic.gdx.physics.box2d
Contact impulses for reporting.
ContactListener - Interface in com.badlogic.gdx.physics.box2d
 
correctionFactor - Variable in class com.badlogic.gdx.physics.box2d.joints.MotorJointDef
Position correction factor in the range [0,1].
COS - Static variable in class com.badlogic.gdx.physics.box2d.Transform
 
createBody(BodyDef) - Method in class com.badlogic.gdx.physics.box2d.World
Create a rigid body given a definition.
createChain(float[]) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Create a chain with isolated end vertices.
createChain(Vector2[]) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Create a chain with isolated end vertices.
createFixture(FixtureDef) - Method in class com.badlogic.gdx.physics.box2d.Body
Creates a fixture and attach it to this body.
createFixture(Shape, float) - Method in class com.badlogic.gdx.physics.box2d.Body
Creates a fixture from a shape and attach it to this body.
createJoint(JointDef) - Method in class com.badlogic.gdx.physics.box2d.World
Create a joint to constrain bodies together.
createLoop(float[]) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Create a loop.
createLoop(Vector2[]) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Create a loop.

D

dampingRatio - Variable in class com.badlogic.gdx.physics.box2d.joints.DistanceJointDef
The damping ratio.
dampingRatio - Variable in class com.badlogic.gdx.physics.box2d.joints.MouseJointDef
The damping ratio.
dampingRatio - Variable in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
Suspension damping ratio, one indicates critical damping
density - Variable in class com.badlogic.gdx.physics.box2d.FixtureDef
The density, usually in kg/m^2.
destroyBody(Body) - Method in class com.badlogic.gdx.physics.box2d.World
Destroy a rigid body given a definition.
destroyFixture(Fixture) - Method in class com.badlogic.gdx.physics.box2d.Body
Destroy a fixture.
destroyJoint(Joint) - Method in class com.badlogic.gdx.physics.box2d.World
Destroy a joint.
DestructionListener - Interface in com.badlogic.gdx.physics.box2d
 
dispose() - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
dispose() - Method in class com.badlogic.gdx.physics.box2d.Shape
Needs to be called when the shape is no longer used, e.g.
dispose() - Method in class com.badlogic.gdx.physics.box2d.World
 
DistanceJoint - Class in com.badlogic.gdx.physics.box2d.joints
A distance joint constrains two points on two bodies to remain at a fixed distance from each other.
DistanceJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
 
DistanceJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Distance joint definition.
DistanceJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.DistanceJointDef
 

E

EdgeShape - Class in com.badlogic.gdx.physics.box2d
A line segment (edge) shape.
EdgeShape() - Constructor for class com.badlogic.gdx.physics.box2d.EdgeShape
 
enableLimit(boolean) - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Enable/disable the joint limit.
enableLimit - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
Enable/disable the joint limit.
enableLimit(boolean) - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Enable/disable the joint limit.
enableLimit - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
A flag to enable joint limits.
enableMotor(boolean) - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Enable/disable the joint motor.
enableMotor - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
Enable/disable the joint motor.
enableMotor(boolean) - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Enable/disable the joint motor.
enableMotor - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
A flag to enable the joint motor.
enableMotor(boolean) - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Enable/disable the joint motor.
enableMotor - Variable in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
Enable/disable the joint motor.
endContact(Contact) - Method in interface com.badlogic.gdx.physics.box2d.ContactListener
Called when two fixtures cease to touch.

F

Filter - Class in com.badlogic.gdx.physics.box2d
This holds contact filtering data.
Filter() - Constructor for class com.badlogic.gdx.physics.box2d.Filter
 
filter - Variable in class com.badlogic.gdx.physics.box2d.FixtureDef
Contact filtering data.
fixedRotation - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
Should this body be prevented from rotating? Useful for characters.
Fixture - Class in com.badlogic.gdx.physics.box2d
 
FixtureDef - Class in com.badlogic.gdx.physics.box2d
A fixture definition is used to create a fixture.
FixtureDef() - Constructor for class com.badlogic.gdx.physics.box2d.FixtureDef
 
frequencyHz - Variable in class com.badlogic.gdx.physics.box2d.joints.DistanceJointDef
The mass-spring-damper frequency in Hertz.
frequencyHz - Variable in class com.badlogic.gdx.physics.box2d.joints.MouseJointDef
The response speed.
frequencyHz - Variable in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
Suspension frequency, zero indicates no suspension
friction - Variable in class com.badlogic.gdx.physics.box2d.FixtureDef
The friction coefficient, usually in the range [0,1].
FrictionJoint - Class in com.badlogic.gdx.physics.box2d.joints
Friction joint.
FrictionJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.FrictionJoint
 
FrictionJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Friction joint definition.
FrictionJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.FrictionJointDef
 

G

GearJoint - Class in com.badlogic.gdx.physics.box2d.joints
A gear joint is used to connect two joints together.
GearJoint(World, long, Joint, Joint) - Constructor for class com.badlogic.gdx.physics.box2d.joints.GearJoint
 
GearJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Gear joint definition.
GearJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.GearJointDef
 
getAnchorA() - Method in class com.badlogic.gdx.physics.box2d.Joint
 
getAnchorB() - Method in class com.badlogic.gdx.physics.box2d.Joint
 
getAngle() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the angle in radians.
getAngularDamping() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the angular damping of the body.
getAngularOffset() - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
getAngularVelocity() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the angular velocity.
getAutoClearForces() - Method in class com.badlogic.gdx.physics.box2d.World
Get the flag that controls automatic clearing of forces after each time step.
getAxis() - Static method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
getBodies(Array<Body>) - Method in class com.badlogic.gdx.physics.box2d.World
 
getBody() - Method in class com.badlogic.gdx.physics.box2d.Fixture
Get the parent body of this fixture.
getBodyA() - Method in class com.badlogic.gdx.physics.box2d.Joint
Get the first body attached to this joint.
getBodyB() - Method in class com.badlogic.gdx.physics.box2d.Joint
Get the second body attached to this joint.
getBodyCount() - Method in class com.badlogic.gdx.physics.box2d.World
Get the number of bodies.
getChildCount() - Method in class com.badlogic.gdx.physics.box2d.Shape
Get the number of child primitives.
getChildIndexA() - Method in class com.badlogic.gdx.physics.box2d.Contact
Get the child primitive index for fixture A.
getChildIndexB() - Method in class com.badlogic.gdx.physics.box2d.Contact
Get the child primitive index for fixture B.
getCollideConnected() - Method in class com.badlogic.gdx.physics.box2d.Joint
 
getContactCount() - Method in class com.badlogic.gdx.physics.box2d.World
Get the number of contacts (each may have 0 or more contact points).
getContactList() - Method in class com.badlogic.gdx.physics.box2d.World
Returns the list of Contact instances produced by the last call to World.step(float, int, int).
getCorrectionFactor() - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
getCount() - Method in class com.badlogic.gdx.physics.box2d.ContactImpulse
 
getDampingRatio() - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
Set/get damping ratio.
getDampingRatio() - Method in class com.badlogic.gdx.physics.box2d.joints.MouseJoint
Set/get the damping ratio (dimensionless).
getDensity() - Method in class com.badlogic.gdx.physics.box2d.Fixture
Get the density of this fixture.
getFilterData() - Method in class com.badlogic.gdx.physics.box2d.Fixture
 
getFixtureA() - Method in class com.badlogic.gdx.physics.box2d.Contact
Get the first fixture in this contact.
getFixtureB() - Method in class com.badlogic.gdx.physics.box2d.Contact
Get the second fixture in this contact.
getFixtureList() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the list of all fixtures attached to this body.
getFrequency() - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
Set/get frequency in Hz.
getFrequency() - Method in class com.badlogic.gdx.physics.box2d.joints.MouseJoint
Set/get the frequency in Hertz.
getFriction() - Method in class com.badlogic.gdx.physics.box2d.Contact
Get the friction.
getFriction() - Method in class com.badlogic.gdx.physics.box2d.Fixture
Get the coefficient of friction.
getGravity() - Method in class com.badlogic.gdx.physics.box2d.World
 
getGravityScale() - Method in class com.badlogic.gdx.physics.box2d.Body
 
getGroundAnchorA() - Method in class com.badlogic.gdx.physics.box2d.joints.PulleyJoint
 
getGroundAnchorB() - Method in class com.badlogic.gdx.physics.box2d.joints.PulleyJoint
 
getInertia() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the rotational inertia of the body about the local origin.
getJoint1() - Method in class com.badlogic.gdx.physics.box2d.joints.GearJoint
Get first joint.
getJoint2() - Method in class com.badlogic.gdx.physics.box2d.joints.GearJoint
Get first joint.
getJointAngle() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Get the current joint angle in radians.
getJointCount() - Method in class com.badlogic.gdx.physics.box2d.World
Get the number of joints.
getJointList() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the list of all joints attached to this body.
getJoints(Array<Joint>) - Method in class com.badlogic.gdx.physics.box2d.World
 
getJointSpeed() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Get the current joint translation speed, usually in meters per second.
getJointSpeed() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Get the current joint angle speed in radians per second.
getJointSpeed() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Get the current joint translation speed, usually in meters per second.
getJointTranslation() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Get the current joint translation, usually in meters.
getJointTranslation() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Get the current joint translation, usually in meters.
getLength() - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
Set/get the natural length.
getLength1() - Method in class com.badlogic.gdx.physics.box2d.joints.PulleyJoint
Get the current length of the segment attached to body1.
getLength2() - Method in class com.badlogic.gdx.physics.box2d.joints.PulleyJoint
Get the current length of the segment attached to body2.
getLinearDamping() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the linear damping of the body.
getLinearOffset() - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
getLinearVelocity() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the linear velocity of the center of mass.
getLinearVelocityFromLocalPoint(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Body
Get the world velocity of a local point.
getLinearVelocityFromWorldPoint(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Body
Get the world linear velocity of a world point attached to this body.
getLocalAnchorA() - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
 
getLocalAnchorA() - Method in class com.badlogic.gdx.physics.box2d.joints.FrictionJoint
 
getLocalAnchorA() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
 
getLocalAnchorA() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
 
getLocalAnchorA() - Method in class com.badlogic.gdx.physics.box2d.joints.RopeJoint
 
getLocalAnchorA() - Method in class com.badlogic.gdx.physics.box2d.joints.WeldJoint
 
getLocalAnchorA() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
 
getLocalAnchorB() - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
 
getLocalAnchorB() - Method in class com.badlogic.gdx.physics.box2d.joints.FrictionJoint
 
getLocalAnchorB() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
 
getLocalAnchorB() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
 
getLocalAnchorB() - Method in class com.badlogic.gdx.physics.box2d.joints.RopeJoint
 
getLocalAnchorB() - Method in class com.badlogic.gdx.physics.box2d.joints.WeldJoint
 
getLocalAnchorB() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
 
getLocalAxisA() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
 
getLocalAxisA() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
 
getLocalCenter() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the local position of the center of mass.
getLocalNormal() - Method in class com.badlogic.gdx.physics.box2d.Manifold
 
getLocalPoint(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Body
Gets a local point relative to the body's origin given a world point.
getLocalPoint() - Method in class com.badlogic.gdx.physics.box2d.Manifold
 
getLocalVector(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Body
Gets a local vector given a world vector.
getLowerLimit() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Get the lower joint limit, usually in meters.
getLowerLimit() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Get the lower joint limit in radians.
getMass() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the total mass of the body.
getMassData() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the mass data of the body.
getMaxForce() - Method in class com.badlogic.gdx.physics.box2d.joints.FrictionJoint
Get the maximum friction force in N.
getMaxForce() - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
getMaxForce() - Method in class com.badlogic.gdx.physics.box2d.joints.MouseJoint
Set/get the maximum force in Newtons.
getMaxLength() - Method in class com.badlogic.gdx.physics.box2d.joints.RopeJoint
Get the maximum length of the rope.
getMaxMotorForce() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Get the max motor force, usually in N.
getMaxMotorTorque() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
 
getMaxMotorTorque() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
 
getMaxTorque() - Method in class com.badlogic.gdx.physics.box2d.joints.FrictionJoint
Get the maximum friction torque in N*m.
getMaxTorque() - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
getMotorForce(float) - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Get the current motor force given the inverse time step, usually in N.
getMotorSpeed() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Get the motor speed, usually in meters per second.
getMotorSpeed() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Get the motor speed in radians per second.
getMotorSpeed() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Get the motor speed, usually in radians per second.
getMotorTorque(float) - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Get the current motor torque, usually in N-m.
getMotorTorque(float) - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Get the current motor torque given the inverse time step, usually in N-m.
getNormal() - Method in class com.badlogic.gdx.physics.box2d.WorldManifold
Returns the normal of this manifold
getNormalImpulses() - Method in class com.badlogic.gdx.physics.box2d.ContactImpulse
 
getNumberOfContactPoints() - Method in class com.badlogic.gdx.physics.box2d.WorldManifold
 
getPointCount() - Method in class com.badlogic.gdx.physics.box2d.Manifold
 
getPoints() - Method in class com.badlogic.gdx.physics.box2d.Manifold
 
getPoints() - Method in class com.badlogic.gdx.physics.box2d.WorldManifold
Returns the contact points of this manifold.
getPosition() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the world body origin position.
getPosition() - Method in class com.badlogic.gdx.physics.box2d.CircleShape
 
getPosition() - Method in class com.badlogic.gdx.physics.box2d.Transform
 
getProxyCount() - Method in class com.badlogic.gdx.physics.box2d.World
Get the number of broad-phase proxies.
getRadius() - Method in class com.badlogic.gdx.physics.box2d.Shape
Returns the radius of this shape
getRatio() - Method in class com.badlogic.gdx.physics.box2d.joints.GearJoint
Get the gear ratio.
getRatio() - Method in class com.badlogic.gdx.physics.box2d.joints.PulleyJoint
Get the pulley ratio.
getReactionForce(float) - Method in class com.badlogic.gdx.physics.box2d.Joint
 
getReactionTorque(float) - Method in class com.badlogic.gdx.physics.box2d.Joint
Get the reaction torque on body2 in N*m.
getReferenceAngle() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Get the reference angle.
getReferenceAngle() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Get the current motor torque, usually in N-m.
getReferenceAngle() - Method in class com.badlogic.gdx.physics.box2d.joints.WeldJoint
 
getRestitution() - Method in class com.badlogic.gdx.physics.box2d.Contact
Get the restitution.
getRestitution() - Method in class com.badlogic.gdx.physics.box2d.Fixture
Get the coefficient of restitution.
getRotation() - Method in class com.badlogic.gdx.physics.box2d.Transform
 
getSeparations() - Method in class com.badlogic.gdx.physics.box2d.WorldManifold
Returns the separations of this manifold, a negative value indicates overlap, in meters.
getShape() - Method in class com.badlogic.gdx.physics.box2d.Fixture
Returns the shape of this fixture
getSpringDampingRatio() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
 
getSpringFrequencyHz() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
 
getTangentImpulses() - Method in class com.badlogic.gdx.physics.box2d.ContactImpulse
 
getTangentSpeed() - Method in class com.badlogic.gdx.physics.box2d.Contact
Get the tangent speed.
getTarget() - Method in class com.badlogic.gdx.physics.box2d.joints.MouseJoint
 
getTransform() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the body transform for the body's origin.
getType() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the type of this body.
getType() - Method in class com.badlogic.gdx.physics.box2d.ChainShape
 
getType() - Method in class com.badlogic.gdx.physics.box2d.CircleShape
Get the type of this shape.
getType() - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
getType() - Method in class com.badlogic.gdx.physics.box2d.Fixture
Get the type of the child shape.
getType() - Method in class com.badlogic.gdx.physics.box2d.Joint
Get the type of the concrete joint.
getType() - Method in class com.badlogic.gdx.physics.box2d.Manifold
 
getType() - Method in class com.badlogic.gdx.physics.box2d.PolygonShape
Get the type of this shape.
getType() - Method in class com.badlogic.gdx.physics.box2d.Shape
Get the type of this shape.
getUpperLimit() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Get the upper joint limit, usually in meters.
getUpperLimit() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Get the upper joint limit in radians.
getUserData() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the user data
getUserData() - Method in class com.badlogic.gdx.physics.box2d.Fixture
 
getUserData() - Method in class com.badlogic.gdx.physics.box2d.Joint
Get the user data
getValue() - Method in enum com.badlogic.gdx.physics.box2d.BodyDef.BodyType
 
getValue() - Method in enum com.badlogic.gdx.physics.box2d.JointDef.JointType
 
getVelocityThreshold() - Static method in class com.badlogic.gdx.physics.box2d.World
 
getVertex(int, Vector2) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Returns the vertex at the given position.
getVertex(int, Vector2) - Method in class com.badlogic.gdx.physics.box2d.PolygonShape
Returns the vertex at the given position.
getVertex0(Vector2) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
getVertex1(Vector2) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
getVertex2(Vector2) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
getVertex3(Vector2) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
getVertexCount() - Method in class com.badlogic.gdx.physics.box2d.ChainShape
 
getVertexCount() - Method in class com.badlogic.gdx.physics.box2d.PolygonShape
 
getWorld() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the parent world of this body.
getWorldCenter() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the world position of the center of mass.
getWorldManifold() - Method in class com.badlogic.gdx.physics.box2d.Contact
 
getWorldPoint(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Body
Get the world coordinates of a point given the local coordinates.
getWorldVector(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Body
Get the world coordinates of a vector given the local coordinates.
gravityScale - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
Scale the gravity applied to this body.
groundAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
The first ground anchor in world coordinates.
groundAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
The second ground anchor in world coordinates.
groupIndex - Variable in class com.badlogic.gdx.physics.box2d.Filter
Collision groups allow a certain group of objects to never collide (negative) or always collide (positive).

H

hasVertex0() - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
hasVertex3() - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 

I

I - Variable in class com.badlogic.gdx.physics.box2d.MassData
The rotational inertia of the shape about the local origin.
initialize(Body, Body, Vector2, Vector2) - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJointDef
Initialize the bodies, anchors, and length using the world anchors.
initialize(Body, Body, Vector2) - Method in class com.badlogic.gdx.physics.box2d.joints.FrictionJointDef
Initialize the bodies, anchors, axis, and reference angle using the world anchor and world axis.
initialize(Body, Body) - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJointDef
Initialize the bodies and offsets using the current transforms.
initialize(Body, Body, Vector2, Vector2) - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
Initialize the bodies, anchors, axis, and reference angle using the world anchor and world axis.
initialize(Body, Body, Vector2, Vector2, Vector2, Vector2, float) - Method in class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
Initialize the bodies, anchors, lengths, max lengths, and ratio using the world anchors.
initialize(Body, Body, Vector2) - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
Initialize the bodies, anchors, and reference angle using a world anchor point.
initialize(Body, Body, Vector2) - Method in class com.badlogic.gdx.physics.box2d.joints.WeldJointDef
 
initialize(Body, Body, Vector2, Vector2) - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
 
isActive() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the active state of the body.
isActive() - Method in class com.badlogic.gdx.physics.box2d.Joint
Short-cut function to determine if either body is inactive.
isAwake() - Method in class com.badlogic.gdx.physics.box2d.Body
Get the sleeping state of this body.
isBullet() - Method in class com.badlogic.gdx.physics.box2d.Body
Is this body treated like a bullet for continuous collision detection?
isDrawAABBs() - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
isDrawBodies() - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
isDrawContacts() - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
isDrawInactiveBodies() - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
isDrawJoints() - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
isDrawVelocities() - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
isEnabled() - Method in class com.badlogic.gdx.physics.box2d.Contact
Has this contact been disabled?
isFixedRotation() - Method in class com.badlogic.gdx.physics.box2d.Body
Does this body have fixed rotation?
isLimitEnabled() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Is the joint limit enabled?
isLimitEnabled() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Is the joint limit enabled?
isLocked() - Method in class com.badlogic.gdx.physics.box2d.World
Is the world locked (in the middle of a time step).
isLooped() - Method in class com.badlogic.gdx.physics.box2d.ChainShape
 
isMotorEnabled() - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Is the joint motor enabled?
isMotorEnabled() - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Is the joint motor enabled?
isMotorEnabled() - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Is the joint motor enabled?
isSensor() - Method in class com.badlogic.gdx.physics.box2d.Fixture
Is this fixture a sensor (non-solid)?
isSensor - Variable in class com.badlogic.gdx.physics.box2d.FixtureDef
A sensor shape collects contact information but never generates a collision response.
isSleepingAllowed() - Method in class com.badlogic.gdx.physics.box2d.Body
Is this body allowed to sleep
isTouching() - Method in class com.badlogic.gdx.physics.box2d.Contact
 

J

Joint - Class in com.badlogic.gdx.physics.box2d
 
joint - Variable in class com.badlogic.gdx.physics.box2d.JointEdge
 
joint1 - Variable in class com.badlogic.gdx.physics.box2d.joints.GearJointDef
The first revolute/prismatic joint attached to the gear joint.
joint2 - Variable in class com.badlogic.gdx.physics.box2d.joints.GearJointDef
The second revolute/prismatic joint attached to the gear joint.
JOINT_COLOR - Variable in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
JointDef - Class in com.badlogic.gdx.physics.box2d
 
JointDef() - Constructor for class com.badlogic.gdx.physics.box2d.JointDef
 
JointDef.JointType - Enum in com.badlogic.gdx.physics.box2d
 
JointEdge - Class in com.badlogic.gdx.physics.box2d
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.

L

length - Variable in class com.badlogic.gdx.physics.box2d.joints.DistanceJointDef
The natural length between the anchor points.
lengthA - Variable in class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
The a reference length for the segment attached to bodyA.
lengthB - Variable in class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
The a reference length for the segment attached to bodyB.
linearDamping - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
Linear damping is use to reduce the linear velocity.
linearOffset - Variable in class com.badlogic.gdx.physics.box2d.joints.MotorJointDef
Position of bodyB minus the position of bodyA, in bodyA's frame, in meters.
linearVelocity - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
The linear velocity of the body's origin in world co-ordinates.
linVelLoc - Variable in class com.badlogic.gdx.physics.box2d.Body
 
linVelWorld - Variable in class com.badlogic.gdx.physics.box2d.Body
 
localAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.DistanceJointDef
The local anchor point relative to body1's origin.
localAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.FrictionJointDef
The local anchor point relative to bodyA's origin.
localAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
The local anchor point relative to body1's origin.
localAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
The local anchor point relative to bodyA's origin.
localAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
The local anchor point relative to body1's origin.
localAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.RopeJointDef
The local anchor point relative to bodyA's origin.
localAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.WeldJointDef
 
localAnchorA - Variable in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
The local anchor point relative to body1's origin.
localAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.DistanceJointDef
The local anchor point relative to body2's origin.
localAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.FrictionJointDef
The local anchor point relative to bodyB's origin.
localAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
The local anchor point relative to body2's origin.
localAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
The local anchor point relative to bodyB's origin.
localAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
The local anchor point relative to body2's origin.
localAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.RopeJointDef
The local anchor point relative to bodyB's origin.
localAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.WeldJointDef
 
localAnchorB - Variable in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
The local anchor point relative to body2's origin.
localAxisA - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
The local translation axis in body1.
localAxisA - Variable in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
The local translation axis in body1.
localPoint - Variable in class com.badlogic.gdx.physics.box2d.Manifold.ManifoldPoint
 
localPoint2 - Variable in class com.badlogic.gdx.physics.box2d.Body
 
localVector - Variable in class com.badlogic.gdx.physics.box2d.Body
 
lowerAngle - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
The lower angle for the joint limit (radians).
lowerTranslation - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
The lower translation limit, usually in meters.

M

main(String[]) - Static method in class com.badlogic.gdx.physics.box2d.utils.Box2DBuild
 
Manifold - Class in com.badlogic.gdx.physics.box2d
 
Manifold.ManifoldPoint - Class in com.badlogic.gdx.physics.box2d
 
Manifold.ManifoldPoint() - Constructor for class com.badlogic.gdx.physics.box2d.Manifold.ManifoldPoint
 
Manifold.ManifoldType - Enum in com.badlogic.gdx.physics.box2d
 
maskBits - Variable in class com.badlogic.gdx.physics.box2d.Filter
The collision mask bits.
mass - Variable in class com.badlogic.gdx.physics.box2d.MassData
The mass of the shape, usually in kilograms.
MassData - Class in com.badlogic.gdx.physics.box2d
This holds the mass data computed for a shape.
MassData() - Constructor for class com.badlogic.gdx.physics.box2d.MassData
 
maxForce - Variable in class com.badlogic.gdx.physics.box2d.joints.FrictionJointDef
The maximum friction force in N.
maxForce - Variable in class com.badlogic.gdx.physics.box2d.joints.MotorJointDef
The maximum motor force in N.
maxForce - Variable in class com.badlogic.gdx.physics.box2d.joints.MouseJointDef
The maximum constraint force that can be exerted to move the candidate body.
maxLength - Variable in class com.badlogic.gdx.physics.box2d.joints.RopeJointDef
The maximum length of the rope.
maxMotorForce - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
The maximum motor torque, usually in N-m.
maxMotorTorque - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
The maximum motor torque used to achieve the desired motor speed.
maxMotorTorque - Variable in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
The maximum motor torque, usually in N-m.
maxTorque - Variable in class com.badlogic.gdx.physics.box2d.joints.FrictionJointDef
The maximum friction torque in N-m.
maxTorque - Variable in class com.badlogic.gdx.physics.box2d.joints.MotorJointDef
The maximum motor torque in N-m.
MotorJoint - Class in com.badlogic.gdx.physics.box2d.joints
A motor joint is used to control the relative motion between two bodies.
MotorJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
MotorJointDef - Class in com.badlogic.gdx.physics.box2d.joints
 
MotorJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.MotorJointDef
 
motorSpeed - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
The desired motor speed in radians per second.
motorSpeed - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
The desired motor speed.
motorSpeed - Variable in class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
The desired motor speed in radians per second.
MouseJoint - Class in com.badlogic.gdx.physics.box2d.joints
A mouse joint is used to make a point on a body track a specified world point.
MouseJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.MouseJoint
 
MouseJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Mouse joint definition.
MouseJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.MouseJointDef
 
mul(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Transform
Transforms the given vector by this transform

N

normalImpulse - Variable in class com.badlogic.gdx.physics.box2d.Manifold.ManifoldPoint
 

O

other - Variable in class com.badlogic.gdx.physics.box2d.JointEdge
 

P

ParticleEmitterBox2D - Class in com.badlogic.gdx.physics.box2d.graphics
 
ParticleEmitterBox2D(World) - Constructor for class com.badlogic.gdx.physics.box2d.graphics.ParticleEmitterBox2D
Constructs default ParticleEmitterBox2D.
ParticleEmitterBox2D(World, BufferedReader) - Constructor for class com.badlogic.gdx.physics.box2d.graphics.ParticleEmitterBox2D
/**Constructs ParticleEmitterBox2D using bufferedReader.
ParticleEmitterBox2D(World, ParticleEmitter) - Constructor for class com.badlogic.gdx.physics.box2d.graphics.ParticleEmitterBox2D
Constructs ParticleEmitterBox2D fully copying given emitter attributes.
PolygonShape - Class in com.badlogic.gdx.physics.box2d
 
PolygonShape() - Constructor for class com.badlogic.gdx.physics.box2d.PolygonShape
Constructs a new polygon
POS_X - Static variable in class com.badlogic.gdx.physics.box2d.Transform
 
POS_Y - Static variable in class com.badlogic.gdx.physics.box2d.Transform
 
position - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
The world position of the body.
postSolve(Contact, ContactImpulse) - Method in interface com.badlogic.gdx.physics.box2d.ContactListener
 
preSolve(Contact, Manifold) - Method in interface com.badlogic.gdx.physics.box2d.ContactListener
 
PrismaticJoint - Class in com.badlogic.gdx.physics.box2d.joints
A prismatic joint.
PrismaticJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
 
PrismaticJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Prismatic joint definition.
PrismaticJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
 
PulleyJoint - Class in com.badlogic.gdx.physics.box2d.joints
The pulley joint is connected to two bodies and two fixed ground points.
PulleyJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.PulleyJoint
 
PulleyJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Pulley joint definition.
PulleyJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
 

Q

QueryAABB(QueryCallback, float, float, float, float) - Method in class com.badlogic.gdx.physics.box2d.World
Query the world for all fixtures that potentially overlap the provided AABB.
QueryCallback - Interface in com.badlogic.gdx.physics.box2d
Callback class for AABB queries.

R

ratio - Variable in class com.badlogic.gdx.physics.box2d.joints.GearJointDef
The gear ratio.
ratio - Variable in class com.badlogic.gdx.physics.box2d.joints.PulleyJointDef
The pulley ratio, used to simulate a block-and-tackle.
rayCast(RayCastCallback, Vector2, Vector2) - Method in class com.badlogic.gdx.physics.box2d.World
Ray-cast the world for all fixtures in the path of the ray.
RayCastCallback - Interface in com.badlogic.gdx.physics.box2d
Callback class for ray casts.
referenceAngle - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
The constrained angle between the bodies: body2_angle - body1_angle.
referenceAngle - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
The body2 angle minus body1 angle in the reference state (radians).
referenceAngle - Variable in class com.badlogic.gdx.physics.box2d.joints.WeldJointDef
 
refilter() - Method in class com.badlogic.gdx.physics.box2d.Fixture
Call this if you want to establish collision that was previously disabled by b2ContactFilter::ShouldCollide.
render(World, Matrix4) - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
This assumes that the projection matrix has already been set.
reportFixture(Fixture) - Method in interface com.badlogic.gdx.physics.box2d.QueryCallback
Called for each fixture found in the query AABB.
reportRayFixture(Fixture, Vector2, Vector2, float) - Method in interface com.badlogic.gdx.physics.box2d.RayCastCallback
Called for each fixture found in the query.
resetFriction() - Method in class com.badlogic.gdx.physics.box2d.Contact
Reset the friction mixture to the default value.
resetMassData() - Method in class com.badlogic.gdx.physics.box2d.Body
This resets the mass properties to the sum of the mass properties of the fixtures.
ResetRestitution() - Method in class com.badlogic.gdx.physics.box2d.Contact
Reset the restitution to the default value.
restitution - Variable in class com.badlogic.gdx.physics.box2d.FixtureDef
The restitution (elasticity) usually in the range [0,1].
RevoluteJoint - Class in com.badlogic.gdx.physics.box2d.joints
A revolute joint constrains two bodies to share a common point while they are free to rotate about the point.
RevoluteJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
 
RevoluteJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Revolute joint definition.
RevoluteJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
 
RopeJoint - Class in com.badlogic.gdx.physics.box2d.joints
A rope joint enforces a maximum distance between two points on two bodies.
RopeJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.RopeJoint
 
RopeJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Rope joint definition.
RopeJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.RopeJointDef
 

S

set(Vector2, Vector2) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
Set this as an isolated edge.
set(float, float, float, float) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
Set this as an isolated edge.
set(Vector2[]) - Method in class com.badlogic.gdx.physics.box2d.PolygonShape
Copy vertices.
set(float[]) - Method in class com.badlogic.gdx.physics.box2d.PolygonShape
Copy vertices from the given float array.
set(float[], int, int) - Method in class com.badlogic.gdx.physics.box2d.PolygonShape
Copy vertices from the given float array, taking into account the offset and length.
setActive(boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the active state of the body.
setAngularDamping(float) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the angular damping of the body.
setAngularOffset(float) - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
setAngularVelocity(float) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the angular velocity.
setAsBox(float, float) - Method in class com.badlogic.gdx.physics.box2d.PolygonShape
Build vertices to represent an axis-aligned box.
setAsBox(float, float, Vector2, float) - Method in class com.badlogic.gdx.physics.box2d.PolygonShape
Build vertices to represent an oriented box.
setAutoClearForces(boolean) - Method in class com.badlogic.gdx.physics.box2d.World
Set flag to control automatic clearing of forces after each time step.
setAwake(boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the sleep state of the body.
setAxis(Vector2) - Static method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
setBullet(boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Should this body be treated like a bullet for continuous collision detection?
setContactFilter(ContactFilter) - Method in class com.badlogic.gdx.physics.box2d.World
Register a contact filter to provide specific control over collision.
setContactListener(ContactListener) - Method in class com.badlogic.gdx.physics.box2d.World
Register a contact event listener.
setContinuousPhysics(boolean) - Method in class com.badlogic.gdx.physics.box2d.World
Enable/disable continuous physics.
setCorrectionFactor(float) - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
setDampingRatio(float) - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
Set/get damping ratio.
setDampingRatio(float) - Method in class com.badlogic.gdx.physics.box2d.joints.MouseJoint
Set/get the damping ratio (dimensionless).
setDensity(float) - Method in class com.badlogic.gdx.physics.box2d.Fixture
Set the density of this fixture.
setDestructionListener(DestructionListener) - Method in class com.badlogic.gdx.physics.box2d.World
Register a destruction listener.
setDrawAABBs(boolean) - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
setDrawBodies(boolean) - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
setDrawContacts(boolean) - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
setDrawInactiveBodies(boolean) - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
setDrawJoints(boolean) - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
setDrawVelocities(boolean) - Method in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
setEnabled(boolean) - Method in class com.badlogic.gdx.physics.box2d.Contact
Enable/disable this contact.
setFilterData(Filter) - Method in class com.badlogic.gdx.physics.box2d.Fixture
Set the contact filtering data.
setFixedRotation(boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
Set this body to have fixed rotation.
setFrequency(float) - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
Set/get frequency in Hz.
setFrequency(float) - Method in class com.badlogic.gdx.physics.box2d.joints.MouseJoint
Set/get the frequency in Hertz.
setFriction(float) - Method in class com.badlogic.gdx.physics.box2d.Contact
Override the default friction mixture.
setFriction(float) - Method in class com.badlogic.gdx.physics.box2d.Fixture
Set the coefficient of friction.
setGravity(Vector2) - Method in class com.badlogic.gdx.physics.box2d.World
Change the global gravity vector.
setGravityScale(float) - Method in class com.badlogic.gdx.physics.box2d.Body
Sets the gravity scale of the body
setHasVertex0(boolean) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
setHasVertex3(boolean) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
setLength(float) - Method in class com.badlogic.gdx.physics.box2d.joints.DistanceJoint
Set/get the natural length.
setLimits(float, float) - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Set the joint limits, usually in meters.
setLimits(float, float) - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Set the joint limits in radians.
setLinearDamping(float) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the linear damping of the body.
setLinearOffset(Vector2) - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
setLinearVelocity(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the linear velocity of the center of mass.
setLinearVelocity(float, float) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the linear velocity of the center of mass.
setMassData(MassData) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the mass properties to override the mass properties of the fixtures.
setMaxForce(float) - Method in class com.badlogic.gdx.physics.box2d.joints.FrictionJoint
Set the maximum friction force in N.
setMaxForce(float) - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
setMaxForce(float) - Method in class com.badlogic.gdx.physics.box2d.joints.MouseJoint
Set/get the maximum force in Newtons.
setMaxLength(float) - Method in class com.badlogic.gdx.physics.box2d.joints.RopeJoint
Set the maximum length of the rope.
setMaxMotorForce(float) - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Set the maximum motor force, usually in N.
setMaxMotorTorque(float) - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Set the maximum motor torque, usually in N-m.
setMaxMotorTorque(float) - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Set/Get the maximum motor force, usually in N-m.
setMaxTorque(float) - Method in class com.badlogic.gdx.physics.box2d.joints.FrictionJoint
Set the maximum friction torque in N*m.
setMaxTorque(float) - Method in class com.badlogic.gdx.physics.box2d.joints.MotorJoint
 
setMotorSpeed(float) - Method in class com.badlogic.gdx.physics.box2d.joints.PrismaticJoint
Set the motor speed, usually in meters per second.
setMotorSpeed(float) - Method in class com.badlogic.gdx.physics.box2d.joints.RevoluteJoint
Set the motor speed in radians per second.
setMotorSpeed(float) - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Set the motor speed, usually in radians per second.
setNextVertex(Vector2) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Establish connectivity to a vertex that follows the last vertex.
setNextVertex(float, float) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Establish connectivity to a vertex that follows the last vertex.
setPosition(Vector2) - Method in class com.badlogic.gdx.physics.box2d.CircleShape
Sets the position of the shape
setPosition(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Transform
Sets the position of this transform
setPrevVertex(Vector2) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Establish connectivity to a vertex that precedes the first vertex.
setPrevVertex(float, float) - Method in class com.badlogic.gdx.physics.box2d.ChainShape
Establish connectivity to a vertex that precedes the first vertex.
setRadius(float) - Method in class com.badlogic.gdx.physics.box2d.Shape
Sets the radius of this shape
setRatio(float) - Method in class com.badlogic.gdx.physics.box2d.joints.GearJoint
Set the gear ratio.
setRestitution(float) - Method in class com.badlogic.gdx.physics.box2d.Contact
Override the default restitution mixture.
setRestitution(float) - Method in class com.badlogic.gdx.physics.box2d.Fixture
Set the coefficient of restitution.
setRotation(float) - Method in class com.badlogic.gdx.physics.box2d.Transform
Sets the rotation of this transform
setSensor(boolean) - Method in class com.badlogic.gdx.physics.box2d.Fixture
Set if this fixture is a sensor.
setSleepingAllowed(boolean) - Method in class com.badlogic.gdx.physics.box2d.Body
You can disable sleeping on this body.
setSpringDampingRatio(float) - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Set/Get the spring damping ratio
setSpringFrequencyHz(float) - Method in class com.badlogic.gdx.physics.box2d.joints.WheelJoint
Set/Get the spring frequency in hertz.
setTangentSpeed(float) - Method in class com.badlogic.gdx.physics.box2d.Contact
Set the tangent speed.
setTarget(Vector2) - Method in class com.badlogic.gdx.physics.box2d.joints.MouseJoint
Use this to update the target point.
setTransform(Vector2, float) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the position of the body's origin and rotation.
setTransform(float, float, float) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the position of the body's origin and rotation.
setType(BodyDef.BodyType) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the type of this body.
setUserData(Object) - Method in class com.badlogic.gdx.physics.box2d.Body
Set the user data
setUserData(Object) - Method in class com.badlogic.gdx.physics.box2d.Fixture
Sets custom user data.
setUserData(Object) - Method in class com.badlogic.gdx.physics.box2d.Joint
Set the user data
setVelocityThreshold(float) - Static method in class com.badlogic.gdx.physics.box2d.World
Sets the box2d velocity threshold globally, for all World instances.
setVertex0(Vector2) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
setVertex0(float, float) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
setVertex3(Vector2) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
setVertex3(float, float) - Method in class com.badlogic.gdx.physics.box2d.EdgeShape
 
setWarmStarting(boolean) - Method in class com.badlogic.gdx.physics.box2d.World
Enable/disable warm starting.
shape - Variable in class com.badlogic.gdx.physics.box2d.FixtureDef
The shape, this must be set.
Shape - Class in com.badlogic.gdx.physics.box2d
A shape is used for collision detection.
Shape() - Constructor for class com.badlogic.gdx.physics.box2d.Shape
 
Shape.Type - Enum in com.badlogic.gdx.physics.box2d
Enum describing the type of a shape
SHAPE_AWAKE - Variable in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
SHAPE_KINEMATIC - Variable in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
SHAPE_NOT_ACTIVE - Variable in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
SHAPE_NOT_AWAKE - Variable in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
SHAPE_STATIC - Variable in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 
shouldCollide(Fixture, Fixture) - Method in interface com.badlogic.gdx.physics.box2d.ContactFilter
 
SIN - Static variable in class com.badlogic.gdx.physics.box2d.Transform
 
step(float, int, int) - Method in class com.badlogic.gdx.physics.box2d.World
Take a time step.

T

tangentImpulse - Variable in class com.badlogic.gdx.physics.box2d.Manifold.ManifoldPoint
 
target - Variable in class com.badlogic.gdx.physics.box2d.joints.MouseJointDef
The initial world target point.
testPoint(Vector2) - Method in class com.badlogic.gdx.physics.box2d.Fixture
Test a point for containment in this fixture.
testPoint(float, float) - Method in class com.badlogic.gdx.physics.box2d.Fixture
Test a point for containment in this fixture.
toString() - Method in class com.badlogic.gdx.physics.box2d.Manifold.ManifoldPoint
 
Transform - Class in com.badlogic.gdx.physics.box2d
Encodes a Box2D transform.
Transform() - Constructor for class com.badlogic.gdx.physics.box2d.Transform
 
Transform(Vector2, float) - Constructor for class com.badlogic.gdx.physics.box2d.Transform
Constructs a new Transform instance with the given position and angle
type - Variable in class com.badlogic.gdx.physics.box2d.BodyDef
The body type: static, kinematic, or dynamic.
type - Variable in class com.badlogic.gdx.physics.box2d.JointDef
The joint type is set automatically for concrete joint types.

U

upperAngle - Variable in class com.badlogic.gdx.physics.box2d.joints.RevoluteJointDef
The upper angle for the joint limit (radians).
upperTranslation - Variable in class com.badlogic.gdx.physics.box2d.joints.PrismaticJointDef
The upper translation limit, usually in meters.

V

vals - Variable in class com.badlogic.gdx.physics.box2d.Transform
 
valueOf(String) - Static method in enum com.badlogic.gdx.physics.box2d.BodyDef.BodyType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.badlogic.gdx.physics.box2d.JointDef.JointType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.badlogic.gdx.physics.box2d.Manifold.ManifoldType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.badlogic.gdx.physics.box2d.Shape.Type
Returns the enum constant of this type with the specified name.
values() - Static method in enum com.badlogic.gdx.physics.box2d.BodyDef.BodyType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.badlogic.gdx.physics.box2d.JointDef.JointType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.badlogic.gdx.physics.box2d.Manifold.ManifoldType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.badlogic.gdx.physics.box2d.Shape.Type
Returns an array containing the constants of this enum type, in the order they are declared.
valueTypes - Static variable in enum com.badlogic.gdx.physics.box2d.JointDef.JointType
 
VELOCITY_COLOR - Variable in class com.badlogic.gdx.physics.box2d.Box2DDebugRenderer
 

W

WeldJoint - Class in com.badlogic.gdx.physics.box2d.joints
A weld joint essentially glues two bodies together.
WeldJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.WeldJoint
 
WeldJointDef - Class in com.badlogic.gdx.physics.box2d.joints
 
WeldJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.WeldJointDef
 
WheelJoint - Class in com.badlogic.gdx.physics.box2d.joints
A wheel joint.
WheelJoint(World, long) - Constructor for class com.badlogic.gdx.physics.box2d.joints.WheelJoint
 
WheelJointDef - Class in com.badlogic.gdx.physics.box2d.joints
Wheel joint definition.
WheelJointDef() - Constructor for class com.badlogic.gdx.physics.box2d.joints.WheelJointDef
 
World - Class in com.badlogic.gdx.physics.box2d
The world class manages all physics entities, dynamic simulation, and asynchronous queries.
World(Vector2, boolean) - Constructor for class com.badlogic.gdx.physics.box2d.World
Construct a world object.
WorldManifold - Class in com.badlogic.gdx.physics.box2d
This is used to compute the current state of a contact manifold.
A B C D E F G H I J L M N O P Q R S T U V W 

Copyright © 2014. All Rights Reserved.