Uses of Class
org.jbox2d.common.Vec2
Packages that use Vec2
Package
Description
-
Uses of Vec2 in org.jbox2d.callbacks
Methods in org.jbox2d.callbacks that return Vec2Modifier and TypeMethodDescriptionDebugDraw.getScreenToWorld
(float screenX, float screenY) takes the screen coordinates and returns the world coordinates.DebugDraw.getScreenToWorld
(Vec2 argScreen) takes the screen coordinates (argScreen) and returns the world coordinatesDebugDraw.getWorldToScreen
(float worldX, float worldY) Takes the world coordinates and returns the screen coordinates.DebugDraw.getWorldToScreen
(Vec2 argWorld) takes the world coordinate (argWorld) and returns the screen coordinates.Methods in org.jbox2d.callbacks with parameters of type Vec2Modifier and TypeMethodDescriptionabstract void
DebugDraw.drawCircle
(Vec2 center, float radius, Color3f color) Draw a circle.abstract void
void
DebugDraw.drawPolygon
(Vec2[] vertices, int vertexCount, Color3f color) Draw a closed polygon provided in CCW order.abstract void
DebugDraw.drawSegment
(Vec2 p1, Vec2 p2, Color3f color) Draw a line segment.abstract void
DebugDraw.drawSolidCircle
(Vec2 center, float radius, Vec2 axis, Color3f color) Draw a solid circle.abstract void
DebugDraw.drawSolidPolygon
(Vec2[] vertices, int vertexCount, Color3f color) Draw a solid closed polygon provided in CCW order.void
DebugDraw.drawString
(Vec2 pos, java.lang.String s, Color3f color) DebugDraw.getScreenToWorld
(Vec2 argScreen) takes the screen coordinates (argScreen) and returns the world coordinatesvoid
DebugDraw.getScreenToWorldToOut
(float screenX, float screenY, Vec2 argWorld) takes the screen coordinates and puts the corresponding world coordinates in argWorld.void
DebugDraw.getScreenToWorldToOut
(Vec2 argScreen, Vec2 argWorld) DebugDraw.getWorldToScreen
(Vec2 argWorld) takes the world coordinate (argWorld) and returns the screen coordinates.void
DebugDraw.getWorldToScreenToOut
(float worldX, float worldY, Vec2 argScreen) Takes the world coordinates and puts the corresponding screen coordinates in argScreen.void
DebugDraw.getWorldToScreenToOut
(Vec2 argWorld, Vec2 argScreen) float
RayCastCallback.reportFixture
(Fixture fixture, Vec2 point, Vec2 normal, float fraction) Called for each fixture found in the query. -
Uses of Vec2 in org.jbox2d.collision
Fields in org.jbox2d.collision declared as Vec2Modifier and TypeFieldDescriptionprivate final Vec2
SeparationFunction.axisA
private final Vec2
SeparationFunction.axisB
private final Vec2
Distance.Simplex.case2
private final Vec2
Distance.Simplex.case22
private final Vec2
Distance.Simplex.case3
private final Vec2
Distance.Simplex.case33
private Vec2
Distance.closestPoint
private static Vec2
Collision.d
private Vec2
Distance.d
private final Vec2
Collision.e
private final Vec2
Collision.e1
private final Vec2
Distance.Simplex.e12
private final Vec2
Distance.Simplex.e13
private final Vec2
Distance.Simplex.e23
private final Vec2
Collision.EPCollider.edge0
private final Vec2
Collision.EPCollider.edge1
private final Vec2
Collision.EPCollider.edge2
private final Vec2
Collision.localNormal
final Vec2
Manifold.localNormal
not use for Type::e_pointsfinal Vec2
Manifold.localPoint
usage depends on manifold typefinal Vec2
ManifoldPoint.localPoint
usage depends on manifold typeprivate final Vec2
SeparationFunction.localPointA
private final Vec2
SeparationFunction.localPointA1
private final Vec2
SeparationFunction.localPointA2
private final Vec2
SeparationFunction.localPointB
private final Vec2
SeparationFunction.localPointB1
private final Vec2
SeparationFunction.localPointB2
private final Vec2
Collision.localTangent
final Vec2
AABB.lowerBound
Bottom left vertex of bounding box.final Vec2
SeparationFunction.m_axis
final Vec2[]
Distance.DistanceProxy.m_buffer
(package private) final Vec2
Collision.EPCollider.m_centroidB
final Vec2
SeparationFunction.m_localPoint
(package private) final Vec2
Collision.EPCollider.m_lowerLimit
(package private) final Vec2
Collision.EPCollider.m_normal
(package private) final Vec2
Collision.EPCollider.m_normal0
(package private) final Vec2
Collision.EPCollider.m_normal1
(package private) final Vec2
Collision.EPCollider.m_normal2
(package private) final Vec2
Collision.EPCollider.m_upperLimit
(package private) Vec2
Collision.EPCollider.m_v0
(package private) Vec2
Collision.EPCollider.m_v1
(package private) Vec2
Collision.EPCollider.m_v2
(package private) Vec2
Collision.EPCollider.m_v3
final Vec2[]
Distance.DistanceProxy.m_vertices
private final Vec2
Collision.EPCollider.n
private final Vec2
Collision.n
(package private) final Vec2
Collision.ReferenceFace.normal
private Vec2
Distance.normal
final Vec2
RayCastOutput.normal
private final Vec2
SeparationFunction.normal
final Vec2
WorldManifold.normal
World vector pointing from A to B(package private) final Vec2[]
Collision.TempPolygon.normals
private final Vec2
Collision.P
final Vec2
RayCastInput.p1
final Vec2
RayCastInput.p2
private final Vec2
Collision.EPCollider.perp
private final Vec2
Collision.planePoint
final Vec2
DistanceOutput.pointA
Closest point on shapeAprivate final Vec2
SeparationFunction.pointA
final Vec2
DistanceOutput.pointB
Closest point on shapeBprivate final Vec2
SeparationFunction.pointB
final Vec2[]
WorldManifold.points
World contact point (point of intersection)private final Vec2
WorldManifold.pool3
private final Vec2
WorldManifold.pool4
private final Vec2
Collision.Q
(package private) final Vec2
Collision.ReferenceFace.sideNormal1
(package private) final Vec2
Collision.ReferenceFace.sideNormal2
private final Vec2
Collision.tangent
private final Vec2
Collision.EPCollider.temp
private final Vec2
Collision.temp
private Vec2
Distance.temp
private final Vec2
SeparationFunction.temp
final Vec2
AABB.upperBound
Top right vertex of bounding box.final Vec2
Collision.ClipVertex.v
(package private) final Vec2
Collision.ReferenceFace.v1
private final Vec2
Collision.v11
private final Vec2
Collision.v12
(package private) final Vec2
Collision.ReferenceFace.v2
(package private) final Vec2[]
Collision.TempPolygon.vertices
final Vec2
Distance.SimplexVertex.w
private final Vec2
Distance.Simplex.w1
private final Vec2
Distance.Simplex.w2
private final Vec2
Distance.Simplex.w3
final Vec2
Distance.SimplexVertex.wA
final Vec2
Distance.SimplexVertex.wB
Methods in org.jbox2d.collision that return Vec2Modifier and TypeMethodDescriptionfinal Vec2
AABB.getCenter()
Get the center of the AABBfinal Vec2
AABB.getExtents()
Get the extents of the AABB (half-widths).final Vec2
Distance.DistanceProxy.getSupportVertex
(Vec2 d) Get the supporting vertex in the given direction.final Vec2
Distance.DistanceProxy.getVertex
(int index) Get a vertex by index.Methods in org.jbox2d.collision with parameters of type Vec2Modifier and TypeMethodDescriptionstatic final int
Collision.clipSegmentToLine
(Collision.ClipVertex[] vOut, Collision.ClipVertex[] vIn, Vec2 normal, float offset, int vertexIndexA) Clipping for contact manifolds.final void
AABB.getCenterToOut
(Vec2 out) void
Distance.Simplex.getClosestPoint
(Vec2 out) this returns pooled objects.final void
AABB.getExtentsToOut
(Vec2 out) final void
Distance.Simplex.getSearchDirection
(Vec2 out) final int
Distance.DistanceProxy.getSupport
(Vec2 d) Get the supporting vertex index in the given direction.final Vec2
Distance.DistanceProxy.getSupportVertex
(Vec2 d) Get the supporting vertex in the given direction.final void
AABB.getVertices
(Vec2[] argRay) void
Distance.Simplex.getWitnessPoints
(Vec2 pA, Vec2 pB) Constructors in org.jbox2d.collision with parameters of type Vec2 -
Uses of Vec2 in org.jbox2d.collision.broadphase
Fields in org.jbox2d.collision.broadphase declared as Vec2Modifier and TypeFieldDescriptionprivate final Vec2[]
DynamicTree.drawVecs
private final Vec2
DynamicTree.r
private final Vec2
DynamicTree.textVec
Methods in org.jbox2d.collision.broadphase with parameters of type Vec2Modifier and TypeMethodDescriptionfinal void
Call MoveProxy as many times as you like, then when you are done call UpdatePairs to finalized the proxy pairs (for your time step).boolean
Move a proxy with a swepted AABB.final boolean
-
Uses of Vec2 in org.jbox2d.collision.shapes
Fields in org.jbox2d.collision.shapes declared as Vec2Modifier and TypeFieldDescriptionfinal Vec2
MassData.center
The position of the shape's centroid relative to the shape's origin.final Vec2
PolygonShape.m_centroid
Local position of the shape centroid in parent body frame.final Vec2
ChainShape.m_nextVertex
final Vec2[]
PolygonShape.m_normals
The normals of the shape.final Vec2
CircleShape.m_p
final Vec2
ChainShape.m_prevVertex
final Vec2
EdgeShape.m_vertex0
optional adjacent vertex 1.final Vec2
EdgeShape.m_vertex1
edge vertex 1final Vec2
EdgeShape.m_vertex2
edge vertex 2final Vec2
EdgeShape.m_vertex3
optional adjacent vertex 2.Vec2[]
ChainShape.m_vertices
final Vec2[]
PolygonShape.m_vertices
The vertices of the shape.private final Vec2
EdgeShape.normal
private final Vec2
PolygonShape.pool1
private final Vec2
PolygonShape.pool2
private final Vec2
PolygonShape.pool3
private final Vec2
PolygonShape.pool4
Methods in org.jbox2d.collision.shapes that return Vec2Modifier and TypeMethodDescriptionGet the centroid and apply the supplied transform.PolygonShape.centroidToOut
(Transform xf, Vec2 out) Get the centroid and apply the supplied transform.Vec2[]
PolygonShape.getNormals()
Get the edge normal vectors.final Vec2
CircleShape.getSupportVertex
(Vec2 d) Get the supporting vertex in the given direction.final Vec2
CircleShape.getVertex
(int index) Get a vertex by index.final Vec2
PolygonShape.getVertex
(int index) Get a vertex by index.Vec2[]
PolygonShape.getVertices()
Get the vertices in local coordinates.Methods in org.jbox2d.collision.shapes with parameters of type Vec2Modifier and TypeMethodDescriptionPolygonShape.centroidToOut
(Transform xf, Vec2 out) Get the centroid and apply the supplied transform.final void
PolygonShape.computeCentroidToOut
(Vec2[] vs, int count, Vec2 out) void
ChainShape.createChain
(Vec2[] vertices, int count) Create a chain with isolated end vertices.void
ChainShape.createLoop
(Vec2[] vertices, int count) Create a loop.final int
CircleShape.getSupport
(Vec2 d) Get the supporting vertex index in the given direction.final Vec2
CircleShape.getSupportVertex
(Vec2 d) Get the supporting vertex in the given direction.void
final void
Create a convex hull from the given array of points.final void
Create a convex hull from the given array of points.final void
Build vertices to represent an oriented box.void
ChainShape.setNextVertex
(Vec2 nextVertex) Establish connectivity to a vertex that follows the last vertex.void
ChainShape.setPrevVertex
(Vec2 prevVertex) Establish connectivity to a vertex that precedes the first vertex.boolean
final boolean
boolean
final boolean
abstract boolean
Test a point for containment in this shape. -
Uses of Vec2 in org.jbox2d.common
Fields in org.jbox2d.common declared as Vec2Modifier and TypeFieldDescriptionfinal Vec2
Sweep.c
Center world positionsfinal Vec2
Sweep.c0
Center world positionsfinal Vec2
OBBViewportTransform.OBB.center
final Vec2
Mat22.ex
final Vec2
OBBViewportTransform.OBB.extents
final Vec2
Mat22.ey
final Vec2
Sweep.localCenter
Local center of mass positionfinal Vec2
RaycastResult.normal
final Vec2
Transform.p
The translation caused by the transformprivate static Vec2
Transform.pool
Methods in org.jbox2d.common that return Vec2Modifier and TypeMethodDescriptionfinal Vec2
Vec2.abs()
Return a new vector that has positive components.static final Vec2
final Vec2
Return the sum of this vector and another; does not alter either one.final Vec2
Vec2.addLocal
(float x, float y) Adds values to this vector and returns result - alters this vector.final Vec2
Add another vector to this one and returns result - alters this vector.static final Vec2
final Vec2
Vec2.clone()
Return a copy of this vector.static final Vec2
static final Vec2
IViewportTransform.getCenter()
center of the viewport.OBBViewportTransform.getCenter()
IViewportTransform.getExtents()
This is the half-width and half-height.OBBViewportTransform.getExtents()
static final Vec2
static final Vec2
static final Vec2
final Vec2
Multiply a vector by this matrix.static final Vec2
final Vec2
Vec2.mul
(float a) Return this vector multiplied by a scalar; does not alter this vector.static final Vec2
final Vec2
Vec2.mulLocal
(float a) Multiply this vector by a number and return result - alters this vector.static final Vec2
final Vec2
Multiply a vector by the transpose of this matrix.static final Vec2
final Vec2
Vec2.negate()
Return the negation of this vector; does not alter this vector.final Vec2
Vec2.negateLocal()
Flip the vector and return it - alters this vector.final Vec2
Vec2.set
(float x, float y) Set the vector component-wise.final Vec2
Set this vector to another vector.final Vec2
Vec2.skew()
Get the skew vector such that dot(skew_vec, other) == cross(vec, other)final Vec2
Solve A * x = b where A = this matrix.final Vec2
Solve A * x = b, where b is a column vector.final Vec2
Return the difference of this vector and another; does not alter either one.final Vec2
Subtract another vector from this one and return result - alters this vector.Methods in org.jbox2d.common with parameters of type Vec2Modifier and TypeMethodDescriptionstatic final Vec2
static final void
final Vec2
Return the sum of this vector and another; does not alter either one.final Vec2
Add another vector to this one and returns result - alters this vector.static final Vec2
static final void
MathUtils.clampToOut
(Vec2 a, Vec2 low, Vec2 high, Vec2 dest) static final Vec2
static final Vec2
static final float
static final void
Vec2.crossToOut
(float s, Vec2 a, Vec2 out) static final void
Vec2.crossToOut
(Vec2 a, float s, Vec2 out) static final void
Vec2.crossToOutUnsafe
(float s, Vec2 a, Vec2 out) static final void
Vec2.crossToOutUnsafe
(Vec2 a, float s, Vec2 out) static final float
static final float
MathUtils.distanceSquared
(Vec2 v1, Vec2 v2) static final float
void
IViewportTransform.getScreenToWorld
(Vec2 argScreen, Vec2 argWorld) takes the screen coordinates (argScreen) and puts the corresponding world coordinates in argWorld.void
OBBViewportTransform.getScreenToWorld
(Vec2 argScreen, Vec2 argWorld) void
IViewportTransform.getScreenVectorToWorld
(Vec2 argScreen, Vec2 argWorld) Transforms the given directional screen vector back to the world direction.void
OBBViewportTransform.getScreenVectorToWorld
(Vec2 argScreen, Vec2 argWorld) void
IViewportTransform.getWorldToScreen
(Vec2 argWorld, Vec2 argScreen) takes the world coordinate (argWorld) puts the corresponding screen coordinate in argScreen.void
OBBViewportTransform.getWorldToScreen
(Vec2 argWorld, Vec2 argScreen) void
IViewportTransform.getWorldVectorToScreen
(Vec2 argWorld, Vec2 argScreen) Transforms the given directional vector by the viewport transform (not positional)void
OBBViewportTransform.getWorldVectorToScreen
(Vec2 argWorld, Vec2 argScreen) void
void
static final Vec2
static final void
static final Vec2
static final void
static final Vec2
final Vec2
Multiply a vector by this matrix.static final Vec2
static final Vec2
static final void
Mat33.mul22ToOut
(Mat33 A, Vec2 v, Vec2 out) static final void
Mat33.mul22ToOutUnsafe
(Mat33 A, Vec2 v, Vec2 out) static final void
final void
static final void
static final void
static final void
Mat22.mulToOutUnsafe
(Mat22 R, Vec2 v, Vec2 out) final void
Mat22.mulToOutUnsafe
(Vec2 v, Vec2 out) static final void
Rot.mulToOutUnsafe
(Rot q, Vec2 v, Vec2 out) static final void
Transform.mulToOutUnsafe
(Transform T, Vec2 v, Vec2 out) static final Vec2
final Vec2
Multiply a vector by the transpose of this matrix.static final void
static final Vec2
static final void
Mat22.mulTransToOut
(Mat22 R, Vec2 v, Vec2 out) final void
Mat22.mulTransToOut
(Vec2 v, Vec2 out) static final void
Transform.mulTransToOut
(Transform T, Vec2 v, Vec2 out) static final void
Mat22.mulTransToOutUnsafe
(Mat22 R, Vec2 v, Vec2 out) static final void
Transform.mulTransToOutUnsafe
(Transform T, Vec2 v, Vec2 out) static final void
Rot.mulTransUnsafe
(Rot q, Vec2 v, Vec2 out) static final void
Vec2.negateToOut
(Vec2 a, Vec2 out) final void
Set by column vectors.final void
Set this based on the position and angle.final Vec2
Set this vector to another vector.void
sets the center of the viewport.void
void
IViewportTransform.setExtents
(Vec2 argExtents) This sets the half-width and half-height.void
OBBViewportTransform.setExtents
(Vec2 argExtents) final void
Get the skew vector such that dot(skew_vec, other) == cross(vec, other)final Vec2
Solve A * x = b where A = this matrix.final Vec2
Solve A * x = b, where b is a column vector.final void
Mat33.solve22ToOut
(Vec2 b, Vec2 out) Solve A * x = b, where b is a column vector.final void
Mat22.solveToOut
(Vec2 b, Vec2 out) final Vec2
Return the difference of this vector and another; does not alter either one.final Vec2
Subtract another vector from this one and return result - alters this vector.Constructors in org.jbox2d.common with parameters of type Vec2 -
Uses of Vec2 in org.jbox2d.dynamics
Fields in org.jbox2d.dynamics declared as Vec2Modifier and TypeFieldDescriptionprivate final Vec2
World.axis
private final Vec2
World.cA
private final Vec2
World.cB
private final Vec2
World.center
private final Vec2
World.circCenterMoved
private final Vec2
Fixture.displacement
BodyDef.linearVelocity
The linear velocity of the body in world co-ordinates.private final Vec2
World.liquidOffset
final Vec2
Body.m_force
private final Vec2
World.m_gravity
final Vec2
Body.m_linearVelocity
private final Vec2
WorldRayCastWrapper.point
BodyDef.position
The world position of the body.private final Vec2
WorldRayCastWrapper.temp
private final Vec2
World.v1
private final Vec2
World.v2
Methods in org.jbox2d.dynamics that return Vec2Modifier and TypeMethodDescriptionWorld.getGravity()
Get the global gravity vector.final Vec2
Body.getLinearVelocity()
Get the linear velocity of the center of mass.final Vec2
Body.getLinearVelocityFromLocalPoint
(Vec2 localPoint) Get the world velocity of a local point.final Vec2
Body.getLinearVelocityFromWorldPoint
(Vec2 worldPoint) Get the world linear velocity of a world point attached to this body.final Vec2
Body.getLocalCenter()
Get the local position of the center of mass.final Vec2
Body.getLocalPoint
(Vec2 worldPoint) Gets a local point relative to the body's origin given a world point.final Vec2
Body.getLocalVector
(Vec2 worldVector) Gets a local vector given a world vector.final Vec2
Body.getPosition()
Get the world body origin position.final Vec2
Body.getWorldCenter()
Get the world position of the center of mass.final Vec2
Body.getWorldPoint
(Vec2 localPoint) Get the world coordinates of a point given the local coordinates.final Vec2
Body.getWorldVector
(Vec2 localVector) Get the world coordinates of a vector given the local coordinates.Methods in org.jbox2d.dynamics with parameters of type Vec2Modifier and TypeMethodDescriptionfinal void
Body.applyForce
(Vec2 force, Vec2 point) Apply a force at a world point.final void
Body.applyForceToCenter
(Vec2 force) Apply a force to the center of mass.final void
Body.applyLinearImpulse
(Vec2 impulse, Vec2 point) Apply an impulse at a point.final Vec2
Body.getLinearVelocityFromLocalPoint
(Vec2 localPoint) Get the world velocity of a local point.final void
Body.getLinearVelocityFromLocalPointToOut
(Vec2 localPoint, Vec2 out) final Vec2
Body.getLinearVelocityFromWorldPoint
(Vec2 worldPoint) Get the world linear velocity of a world point attached to this body.final void
Body.getLinearVelocityFromWorldPointToOut
(Vec2 worldPoint, Vec2 out) final Vec2
Body.getLocalPoint
(Vec2 worldPoint) Gets a local point relative to the body's origin given a world point.final void
Body.getLocalPointToOut
(Vec2 worldPoint, Vec2 out) final Vec2
Body.getLocalVector
(Vec2 worldVector) Gets a local vector given a world vector.final void
Body.getLocalVectorToOut
(Vec2 worldVector, Vec2 out) final void
Body.getLocalVectorToOutUnsafe
(Vec2 worldVector, Vec2 out) final Vec2
Body.getWorldPoint
(Vec2 localPoint) Get the world coordinates of a point given the local coordinates.final void
Body.getWorldPointToOut
(Vec2 localPoint, Vec2 out) final Vec2
Body.getWorldVector
(Vec2 localVector) Get the world coordinates of a vector given the local coordinates.final void
Body.getWorldVectorToOut
(Vec2 localVector, Vec2 out) final void
Body.getWorldVectorToOutUnsafe
(Vec2 localVector, Vec2 out) void
World.raycast
(RayCastCallback callback, Vec2 point1, Vec2 point2) Ray-cast the world for all fixtures in the path of the ray.void
World.setGravity
(Vec2 gravity) Change the global gravity vector.final void
Body.setLinearVelocity
(Vec2 v) Set the linear velocity of the center of mass.final void
Body.setTransform
(Vec2 position, float angle) Set the position of the body's origin and rotation.void
boolean
Test a point for containment in this fixture.Constructors in org.jbox2d.dynamics with parameters of type Vec2ModifierConstructorDescriptionConstruct a world object.World
(Vec2 gravity, IWorldPool pool) Construct a world object.World
(Vec2 gravity, IWorldPool argPool, BroadPhaseStrategy broadPhaseStrategy) -
Uses of Vec2 in org.jbox2d.dynamics.contacts
Fields in org.jbox2d.dynamics.contacts declared as Vec2Modifier and TypeFieldDescriptionprivate final Vec2
ContactSolver.a
private final Vec2
ContactSolver.b
final Vec2
Position.c
private final Vec2
ContactSolver.d
private final Vec2
ContactSolver.dv1
private final Vec2
ContactSolver.dv2
(package private) final Vec2
ContactPositionConstraint.localCenterA
(package private) final Vec2
ContactPositionConstraint.localCenterB
(package private) final Vec2
ContactPositionConstraint.localNormal
(package private) final Vec2
ContactPositionConstraint.localPoint
(package private) Vec2[]
ContactPositionConstraint.localPoints
final Vec2
ContactVelocityConstraint.normal
final Vec2
PositionSolverManifold.normal
private final Vec2
ContactSolver.P
private final Vec2
ContactSolver.P1
private final Vec2
ContactSolver.P2
final Vec2
PositionSolverManifold.point
private final Vec2
ContactSolver.rA
final Vec2
ContactVelocityConstraint.VelocityConstraintPoint.rA
private final Vec2
ContactSolver.rB
final Vec2
ContactVelocityConstraint.VelocityConstraintPoint.rB
private final Vec2
ContactSolver.tangent
private final Vec2
ContactSolver.temp
private final Vec2
ContactSolver.temp1
private final Vec2
ContactSolver.temp2
final Vec2
Velocity.v
private final Vec2
ContactSolver.x
-
Uses of Vec2 in org.jbox2d.dynamics.joints
Fields in org.jbox2d.dynamics.joints declared as Vec2Modifier and TypeFieldDescriptionprivate final Vec2
WheelJoint.d
PulleyJointDef.groundAnchorA
The first ground anchor in world coordinates.PulleyJointDef.groundAnchorB
The second ground anchor in world coordinates.final Vec2
Jacobian.linearA
final Vec2
DistanceJointDef.localAnchorA
The local anchor point relative to body1's origin.final Vec2
FrictionJointDef.localAnchorA
The local anchor point relative to bodyA's origin.final Vec2
PrismaticJointDef.localAnchorA
The local anchor point relative to body1's origin.PulleyJointDef.localAnchorA
The local anchor point relative to bodyA's origin.RevoluteJointDef.localAnchorA
The local anchor point relative to body1's origin.final Vec2
RopeJointDef.localAnchorA
The local anchor point relative to bodyA's origin.final Vec2
WeldJointDef.localAnchorA
The local anchor point relative to body1's origin.final Vec2
WheelJointDef.localAnchorA
The local anchor point relative to body1's origin.final Vec2
DistanceJointDef.localAnchorB
The local anchor point relative to body2's origin.final Vec2
FrictionJointDef.localAnchorB
The local anchor point relative to bodyB's origin.final Vec2
PrismaticJointDef.localAnchorB
The local anchor point relative to body2's origin.PulleyJointDef.localAnchorB
The local anchor point relative to bodyB's origin.RevoluteJointDef.localAnchorB
The local anchor point relative to body2's origin.final Vec2
RopeJointDef.localAnchorB
The local anchor point relative to bodyB's origin.final Vec2
WeldJointDef.localAnchorB
The local anchor point relative to body2's origin.final Vec2
WheelJointDef.localAnchorB
The local anchor point relative to body2's origin.final Vec2
PrismaticJointDef.localAxisA
The local translation axis in body1.final Vec2
WheelJointDef.localAxisA
The local translation axis in body1.private final Vec2
WheelJoint.m_ax
private final Vec2
PrismaticJoint.m_axis
private final Vec2
WheelJoint.m_ay
private final Vec2
MouseJoint.m_C
private final Vec2
PulleyJoint.m_groundAnchorA
private final Vec2
PulleyJoint.m_groundAnchorB
private final Vec2
MouseJoint.m_impulse
private final Vec2
GearJoint.m_JvAC
private final Vec2
GearJoint.m_JvBD
private final Vec2
GearJoint.m_lcA
private final Vec2
GearJoint.m_lcB
private final Vec2
GearJoint.m_lcC
private final Vec2
GearJoint.m_lcD
private final Vec2
FrictionJoint.m_linearImpulse
private final Vec2
DistanceJoint.m_localAnchorA
private final Vec2
FrictionJoint.m_localAnchorA
private final Vec2
GearJoint.m_localAnchorA
protected final Vec2
PrismaticJoint.m_localAnchorA
private final Vec2
PulleyJoint.m_localAnchorA
protected final Vec2
RevoluteJoint.m_localAnchorA
private final Vec2
RopeJoint.m_localAnchorA
private final Vec2
WeldJoint.m_localAnchorA
private final Vec2
WheelJoint.m_localAnchorA
private final Vec2
DistanceJoint.m_localAnchorB
private final Vec2
FrictionJoint.m_localAnchorB
private final Vec2
GearJoint.m_localAnchorB
private final Vec2
MouseJoint.m_localAnchorB
protected final Vec2
PrismaticJoint.m_localAnchorB
private final Vec2
PulleyJoint.m_localAnchorB
protected final Vec2
RevoluteJoint.m_localAnchorB
private final Vec2
RopeJoint.m_localAnchorB
private final Vec2
WeldJoint.m_localAnchorB
private final Vec2
WheelJoint.m_localAnchorB
private final Vec2
GearJoint.m_localAnchorC
private final Vec2
GearJoint.m_localAnchorD
private final Vec2
GearJoint.m_localAxisC
private final Vec2
GearJoint.m_localAxisD
private final Vec2
DistanceJoint.m_localCenterA
private final Vec2
FrictionJoint.m_localCenterA
private final Vec2
PrismaticJoint.m_localCenterA
private final Vec2
PulleyJoint.m_localCenterA
private final Vec2
RevoluteJoint.m_localCenterA
private final Vec2
RopeJoint.m_localCenterA
private final Vec2
WeldJoint.m_localCenterA
private final Vec2
WheelJoint.m_localCenterA
private final Vec2
DistanceJoint.m_localCenterB
private final Vec2
FrictionJoint.m_localCenterB
private final Vec2
MouseJoint.m_localCenterB
private final Vec2
PrismaticJoint.m_localCenterB
private final Vec2
PulleyJoint.m_localCenterB
private final Vec2
RevoluteJoint.m_localCenterB
private final Vec2
RopeJoint.m_localCenterB
private final Vec2
WeldJoint.m_localCenterB
private final Vec2
WheelJoint.m_localCenterB
protected final Vec2
PrismaticJoint.m_localXAxisA
private final Vec2
WheelJoint.m_localXAxisA
protected final Vec2
PrismaticJoint.m_localYAxisA
private final Vec2
WheelJoint.m_localYAxisA
private final Vec2
PrismaticJoint.m_perp
private final Vec2
DistanceJoint.m_rA
private final Vec2
FrictionJoint.m_rA
private final Vec2
PulleyJoint.m_rA
private final Vec2
RevoluteJoint.m_rA
private final Vec2
RopeJoint.m_rA
private final Vec2
WeldJoint.m_rA
private final Vec2
DistanceJoint.m_rB
private final Vec2
FrictionJoint.m_rB
private final Vec2
MouseJoint.m_rB
private final Vec2
PulleyJoint.m_rB
private final Vec2
RevoluteJoint.m_rB
private final Vec2
RopeJoint.m_rB
private final Vec2
WeldJoint.m_rB
private final Vec2
MouseJoint.m_targetA
private final Vec2
DistanceJoint.m_u
private final Vec2
RopeJoint.m_u
private final Vec2
PulleyJoint.m_uA
private final Vec2
PulleyJoint.m_uB
private Vec2[]
ConstantVolumeJoint.normals
private final Vec2
WheelJoint.rA
private final Vec2
WheelJoint.rB
final Vec2
MouseJointDef.target
The initial world target point.Methods in org.jbox2d.dynamics.joints that return Vec2Modifier and TypeMethodDescriptionPulleyJoint.getGroundAnchorA()
PulleyJoint.getGroundAnchorB()
DistanceJoint.getLocalAnchorA()
FrictionJoint.getLocalAnchorA()
PrismaticJoint.getLocalAnchorA()
PulleyJoint.getLocalAnchorA()
RevoluteJoint.getLocalAnchorA()
RopeJoint.getLocalAnchorA()
WeldJoint.getLocalAnchorA()
WheelJoint.getLocalAnchorA()
DistanceJoint.getLocalAnchorB()
FrictionJoint.getLocalAnchorB()
PrismaticJoint.getLocalAnchorB()
PulleyJoint.getLocalAnchorB()
RevoluteJoint.getLocalAnchorB()
RopeJoint.getLocalAnchorB()
WeldJoint.getLocalAnchorB()
WheelJoint.getLocalAnchorB()
PrismaticJoint.getLocalAxisA()
WheelJoint.getLocalAxisA()
For serializationMouseJoint.getTarget()
Methods in org.jbox2d.dynamics.joints with parameters of type Vec2Modifier and TypeMethodDescriptionvoid
ConstantVolumeJoint.getAnchorA
(Vec2 argOut) No-opvoid
DistanceJoint.getAnchorA
(Vec2 argOut) void
FrictionJoint.getAnchorA
(Vec2 argOut) void
GearJoint.getAnchorA
(Vec2 argOut) abstract void
Joint.getAnchorA
(Vec2 out) get the anchor point on bodyA in world coordinates.void
MouseJoint.getAnchorA
(Vec2 argOut) void
PrismaticJoint.getAnchorA
(Vec2 argOut) void
PulleyJoint.getAnchorA
(Vec2 argOut) void
RevoluteJoint.getAnchorA
(Vec2 argOut) void
RopeJoint.getAnchorA
(Vec2 argOut) void
WeldJoint.getAnchorA
(Vec2 argOut) void
WheelJoint.getAnchorA
(Vec2 argOut) void
ConstantVolumeJoint.getAnchorB
(Vec2 argOut) No-opvoid
DistanceJoint.getAnchorB
(Vec2 argOut) void
FrictionJoint.getAnchorB
(Vec2 argOut) void
GearJoint.getAnchorB
(Vec2 argOut) abstract void
Joint.getAnchorB
(Vec2 out) get the anchor point on bodyB in world coordinates.void
MouseJoint.getAnchorB
(Vec2 argOut) void
PrismaticJoint.getAnchorB
(Vec2 argOut) void
PulleyJoint.getAnchorB
(Vec2 argOut) void
RevoluteJoint.getAnchorB
(Vec2 argOut) void
RopeJoint.getAnchorB
(Vec2 argOut) void
WeldJoint.getAnchorB
(Vec2 argOut) void
WheelJoint.getAnchorB
(Vec2 argOut) void
ConstantVolumeJoint.getReactionForce
(float inv_dt, Vec2 argOut) No-opvoid
DistanceJoint.getReactionForce
(float inv_dt, Vec2 argOut) Get the reaction force given the inverse time step.void
FrictionJoint.getReactionForce
(float inv_dt, Vec2 argOut) void
GearJoint.getReactionForce
(float inv_dt, Vec2 argOut) abstract void
Joint.getReactionForce
(float inv_dt, Vec2 out) get the reaction force on body2 at the joint anchor in Newtons.void
MouseJoint.getReactionForce
(float invDt, Vec2 argOut) void
PrismaticJoint.getReactionForce
(float inv_dt, Vec2 argOut) void
PulleyJoint.getReactionForce
(float inv_dt, Vec2 argOut) void
RevoluteJoint.getReactionForce
(float inv_dt, Vec2 argOut) void
RopeJoint.getReactionForce
(float inv_dt, Vec2 argOut) void
WeldJoint.getReactionForce
(float inv_dt, Vec2 argOut) void
WheelJoint.getReactionForce
(float inv_dt, Vec2 argOut) void
DistanceJointDef.initialize
(Body b1, Body b2, Vec2 anchor1, Vec2 anchor2) Initialize the bodies, anchors, and length using the world anchors.void
FrictionJointDef.initialize
(Body bA, Body bB, Vec2 anchor) Initialize the bodies, anchors, axis, and reference angle using the world anchor and world axis.void
PrismaticJointDef.initialize
(Body b1, Body b2, Vec2 anchor, Vec2 axis) Initialize the bodies, anchors, axis, and reference angle using the world anchor and world axis.void
PulleyJointDef.initialize
(Body b1, Body b2, Vec2 ga1, Vec2 ga2, Vec2 anchor1, Vec2 anchor2, float r) Initialize the bodies, anchors, lengths, max lengths, and ratio using the world anchors.void
RevoluteJointDef.initialize
(Body b1, Body b2, Vec2 anchor) Initialize the bodies, anchors, and reference angle using the world anchor.void
WeldJointDef.initialize
(Body bA, Body bB, Vec2 anchor) Initialize the bodies, anchors, and reference angle using a world anchor point.void
WheelJointDef.initialize
(Body b1, Body b2, Vec2 anchor, Vec2 axis) void
-
Uses of Vec2 in org.jbox2d.pooling
Methods in org.jbox2d.pooling that return Vec2 -
Uses of Vec2 in org.jbox2d.pooling.arrays
Methods in org.jbox2d.pooling.arrays that return Vec2Modifier and TypeMethodDescriptionVec2[]
Vec2Array.get
(int argLength) protected Vec2[]
Vec2Array.getInitializedArray
(int argLength) -
Uses of Vec2 in org.jbox2d.pooling.normal
Fields in org.jbox2d.pooling.normal with type parameters of type Vec2Methods in org.jbox2d.pooling.normal that return Vec2 -
Uses of Vec2 in org.jbox2d.serialization.pb
Methods in org.jbox2d.serialization.pb that return Vec2Methods in org.jbox2d.serialization.pb with parameters of type Vec2 -
Uses of Vec2 in org.jbox2d.testbed.framework
Fields in org.jbox2d.testbed.framework declared as Vec2Modifier and TypeFieldDescriptionprivate final Vec2
TestbedTest.bombSpawnPoint
private final Vec2
TestbedTest.cachedCameraPos
private final Vec2
TestbedModel.mouse
private final Vec2
TestbedTest.mouseWorld
final Vec2
ContactPoint.normal
QueueItem.p
private final Vec2
TestbedTest.p
private final Vec2
TestbedTest.p1
private final Vec2
TestbedTest.p2
final Vec2
TestQueryCallback.point
final Vec2
ContactPoint.position
private final Vec2
TestbedTest.tangent
private final Vec2
TestbedTest.v
private final Vec2
TestbedTest.vel
Methods in org.jbox2d.testbed.framework that return Vec2Modifier and TypeMethodDescriptionTestbedTest.getCachedCameraPos()
TestbedTest.getDefaultCameraPos()
Override for a different default camera posTestbedModel.getMouse()
TestbedTest.getWorldMouse()
Gets the world position of the mouseMethods in org.jbox2d.testbed.framework with parameters of type Vec2Modifier and TypeMethodDescriptionvoid
TestbedTest.completeBombSpawn
(Vec2 p) void
TestbedTest.launchBomb
(Vec2 position, Vec2 velocity) void
Called for mouse-downvoid
Called when mouse is movedvoid
Called for mouse-upvoid
TestbedTest.queueMouseDown
(Vec2 p) void
TestbedTest.queueMouseMove
(Vec2 p) void
TestbedTest.queueMouseUp
(Vec2 p) void
TestbedTest.queueShiftMouseDown
(Vec2 p) void
TestbedTest.setCachedCameraPos
(Vec2 argPos) void
void
Sets the current testbed cameravoid
void
TestbedTest.shiftMouseDown
(Vec2 p) Called when shift-mouse down occursvoid
Constructors in org.jbox2d.testbed.framework with parameters of type Vec2 -
Uses of Vec2 in org.jbox2d.testbed.framework.j2d
Fields in org.jbox2d.testbed.framework.j2d declared as Vec2Modifier and TypeFieldDescriptionprivate final Vec2
TestPanelJ2D.dragginMouse
private final Vec2
DebugDrawJ2D.saxis
private final Vec2
DebugDrawJ2D.sp1
private final Vec2
DebugDrawJ2D.sp2
private final Vec2
DebugDrawJ2D.temp
private final Vec2
DebugDrawJ2D.temp2
Methods in org.jbox2d.testbed.framework.j2d with parameters of type Vec2Modifier and TypeMethodDescriptionvoid
DebugDrawJ2D.drawCircle
(Vec2 center, float radius, Color3f color) void
void
DebugDrawJ2D.drawSegment
(Vec2 p1, Vec2 p2, Color3f color) void
DebugDrawJ2D.drawSolidCircle
(Vec2 center, float radius, Vec2 axis, Color3f color) void
DebugDrawJ2D.drawSolidPolygon
(Vec2[] vertices, int vertexCount, Color3f color) private void
DebugDrawJ2D.generateCirle
(Vec2 argCenter, float argRadius, Vec2[] argPoints, int argNumPoints) -
Uses of Vec2 in org.jbox2d.testbed.perf
Fields in org.jbox2d.testbed.perf declared as Vec2Modifier and TypeFieldDescriptionPoolingPerf.mv
(package private) final Vec2[]
PoolingPerf.CirclePool.pool
(package private) final Vec2[]
PoolingPerf.CustStack.pool
Methods in org.jbox2d.testbed.perf that return Vec2Modifier and TypeMethodDescriptionfinal Vec2
PoolingPerf.CirclePool.get()
final Vec2
PoolingPerf.CustStack.get()
protected Vec2
PoolingPerf.TLVec2.initialValue()
Methods in org.jbox2d.testbed.perf with parameters of type Vec2 -
Uses of Vec2 in org.jbox2d.testbed.tests
Fields in org.jbox2d.testbed.tests declared as Vec2Modifier and TypeFieldDescription(package private) Vec2
RayCastTest.d
(package private) Vec2
EdgeShapesCallback.m_normal
(package private) Vec2
RayCastAnyCallback.m_normal
(package private) Vec2
RayCastClosestCallback.m_normal
(package private) Vec2[]
RayCastMultipleCallback.m_normals
(package private) Vec2
TheoJansen.m_offset
(package private) Vec2
EdgeShapesCallback.m_point
(package private) Vec2
RayCastAnyCallback.m_point
(package private) Vec2
RayCastClosestCallback.m_point
private Vec2[]
ConvexHull.m_points
(package private) Vec2[]
RayCastMultipleCallback.m_points
(package private) Vec2
DistanceTest.m_positionB
(package private) Vec2
Breakable.m_velocity
(package private) Vec2
RayCastTest.point1
(package private) Vec2
RayCastTest.point2
(package private) Vec2
RayCastTest.pooledHead
(package private) Vec2[]
DistanceTest.v
Methods in org.jbox2d.testbed.tests that return Vec2Modifier and TypeMethodDescriptionCircleStress.getDefaultCameraPos()
DominoTower.getDefaultCameraPos()
Methods in org.jbox2d.testbed.tests with parameters of type Vec2Modifier and TypeMethodDescription(package private) void
float
EdgeShapesCallback.reportFixture
(Fixture fixture, Vec2 point, Vec2 normal, float fraction) float
RayCastAnyCallback.reportFixture
(Fixture fixture, Vec2 point, Vec2 normal, float fraction) float
RayCastClosestCallback.reportFixture
(Fixture fixture, Vec2 point, Vec2 normal, float fraction) float
RayCastMultipleCallback.reportFixture
(Fixture fixture, Vec2 point, Vec2 normal, float fraction)