- Sap<E extends Collidable<T>,T extends Fixture> - Class in org.dyn4j.collision.broadphase
-
Implementation of the Sweep and Prune broad-phase collision detection algorithm.
- Sap() - Constructor for class org.dyn4j.collision.broadphase.Sap
-
Default constructor.
- Sap(int) - Constructor for class org.dyn4j.collision.broadphase.Sap
-
Full constructor.
- Sat - Class in org.dyn4j.collision.narrowphase
-
Implementation of the Separating Axis Theorem (SAT) for collision detection.
- Sat() - Constructor for class org.dyn4j.collision.narrowphase.Sat
-
- scale(Capsule, double) - Static method in class org.dyn4j.geometry.Geometry
-
Returns a scaled version of the given capsule.
- scale(Circle, double) - Static method in class org.dyn4j.geometry.Geometry
-
Returns a scaled version of the given circle.
- scale(Ellipse, double) - Static method in class org.dyn4j.geometry.Geometry
-
Returns a scaled version of the given ellipse.
- scale(HalfEllipse, double) - Static method in class org.dyn4j.geometry.Geometry
-
Returns a scaled version of the given half-ellipse.
- scale(Polygon, double) - Static method in class org.dyn4j.geometry.Geometry
-
Returns a scaled version of the given polygon.
- scale(Segment, double) - Static method in class org.dyn4j.geometry.Geometry
-
Returns a scaled version of the given segment.
- scale(Slice, double) - Static method in class org.dyn4j.geometry.Geometry
-
Returns a scaled version of the given slice.
- search(T) - Method in class org.dyn4j.BinarySearchTree
-
Performs a binary search on this tree given the criteria.
- Segment - Class in org.dyn4j.geometry
-
- Segment(Vector2, Vector2) - Constructor for class org.dyn4j.geometry.Segment
-
Full constructor.
- SegmentDetector - Class in org.dyn4j.collision.narrowphase
-
Class devoted to improving performance of
Segment
detection queries.
- sensed(ContactPoint) - Method in class org.dyn4j.dynamics.contact.ContactAdapter
-
Deprecated.
- sensed(ContactPoint) - Method in interface org.dyn4j.dynamics.contact.ContactListener
-
- Separation - Class in org.dyn4j.collision.narrowphase
-
- Separation() - Constructor for class org.dyn4j.collision.narrowphase.Separation
-
Default constructor.
- Separation(Vector2, double, Vector2, Vector2) - Constructor for class org.dyn4j.collision.narrowphase.Separation
-
Full constructor.
- SequentialImpulses - Class in org.dyn4j.dynamics.contact
-
Represents an impulse based rigid
Body
physics collision resolver.
- SequentialImpulses() - Constructor for class org.dyn4j.dynamics.contact.SequentialImpulses
-
- set(double) - Method in class org.dyn4j.dynamics.Torque
-
Sets this
Torque
to the given torque value.
- set(double, double) - Method in class org.dyn4j.dynamics.Force
-
Sets this
Force
to the given components.
- set(double, double) - Method in class org.dyn4j.geometry.Vector2
-
- set(double, double, double) - Method in class org.dyn4j.geometry.Vector3
-
- set(Force) - Method in class org.dyn4j.dynamics.Force
-
- set(Torque) - Method in class org.dyn4j.dynamics.Torque
-
- set(AABB) - Method in class org.dyn4j.geometry.AABB
-
Sets this aabb to the given aabb's value and returns
this AABB.
- set(Transform) - Method in class org.dyn4j.geometry.Transform
-
Sets this transform to the given transform.
- set(Vector2) - Method in class org.dyn4j.dynamics.Force
-
- set(Vector2) - Method in class org.dyn4j.geometry.Vector2
-
- set(Vector3) - Method in class org.dyn4j.geometry.Vector3
-
- setAABBExpansion(double) - Method in class org.dyn4j.collision.broadphase.AbstractBroadphaseDetector
-
- setAABBExpansion(double) - Method in interface org.dyn4j.collision.broadphase.BroadphaseDetector
-
Sets the
AABB
expansion value used to improve performance of broad-phase updates.
- setAccumulatedTime(double) - Method in class org.dyn4j.dynamics.World
-
Sets the current accumulated time.
- setActive(boolean) - Method in class org.dyn4j.dynamics.Body
-
Sets whether this
Body
is active or not.
- setAngularDamping(double) - Method in class org.dyn4j.dynamics.Body
-
Sets the angular damping.
- setAngularTarget(double) - Method in class org.dyn4j.dynamics.joint.MotorJoint
-
Sets the desired angle between the bodies.
- setAngularTolerance(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the angular tolerance.
- setAngularVelocity(double) - Method in class org.dyn4j.dynamics.Body
-
Sets the angular velocity in radians per second
- setAsleep(boolean) - Method in class org.dyn4j.dynamics.Body
-
Sets whether this
Body
is awake or not.
- setAutoSleepingEnabled(boolean) - Method in class org.dyn4j.dynamics.Body
-
Sets the
Body
to allow or disallow automatic sleeping.
- setAutoSleepingEnabled(boolean) - Method in class org.dyn4j.dynamics.Settings
-
Sets whether the engine automatically puts
Body
s to sleep.
- setBaumgarte(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the baumgarte factor.
- setBody(Body) - Method in class org.dyn4j.dynamics.ConvexCastResult
-
Sets the body.
- setBody(Body) - Method in class org.dyn4j.dynamics.DetectResult
-
Sets the overlapping body.
- setBody(Body) - Method in class org.dyn4j.dynamics.RaycastResult
-
- setBounds(Bounds) - Method in class org.dyn4j.dynamics.World
-
Sets the bounds of this
World
.
- setBroadphaseDetector(BroadphaseDetector<Body, BodyFixture>) - Method in class org.dyn4j.dynamics.World
-
Sets the broad-phase collision detection algorithm.
- setBullet(boolean) - Method in class org.dyn4j.dynamics.Body
-
Sets the bullet flag for this
Body
.
- setCoefficientMixer(CoefficientMixer) - Method in class org.dyn4j.dynamics.World
-
- setCollisionAllowed(boolean) - Method in class org.dyn4j.dynamics.joint.Joint
-
Sets whether collision is allowed between the joined
Body
s.
- setContactConstraintSolver(ContactConstraintSolver) - Method in class org.dyn4j.dynamics.World
-
- setContactManager(ContactManager) - Method in class org.dyn4j.dynamics.World
-
- setContinuousDetectionMode(ContinuousDetectionMode) - Method in class org.dyn4j.dynamics.Settings
-
Sets the continuous collision detection mode.
- setCorrectionFactor(double) - Method in class org.dyn4j.dynamics.joint.MotorJoint
-
Sets the correction factor.
- setDampingRatio(double) - Method in class org.dyn4j.dynamics.joint.DistanceJoint
-
Sets the damping ratio.
- setDampingRatio(double) - Method in class org.dyn4j.dynamics.joint.PinJoint
-
Sets the damping ratio.
- setDampingRatio(double) - Method in class org.dyn4j.dynamics.joint.WeldJoint
-
Sets the damping ratio.
- setDampingRatio(double) - Method in class org.dyn4j.dynamics.joint.WheelJoint
-
Sets the damping ratio.
- setDensity(double) - Method in class org.dyn4j.dynamics.BodyFixture
-
Sets the density of this shape in kg/m2.
- setDepth(double) - Method in class org.dyn4j.collision.manifold.ManifoldPoint
-
Sets the collision depth of the manifold point.
- setDepth(double) - Method in class org.dyn4j.collision.narrowphase.Penetration
-
Sets the penetration depth.
- setDetectBroadphaseFilter(BroadphaseFilter<Body, BodyFixture>) - Method in class org.dyn4j.dynamics.World
-
- setDetectEpsilon(double) - Method in class org.dyn4j.collision.narrowphase.Gjk
-
The minimum distance to determine that two shapes are not colliding.
- setDirection(double) - Method in class org.dyn4j.geometry.Ray
-
Sets the direction of this ray in radians.
- setDirection(double) - Method in class org.dyn4j.geometry.Vector2
-
Sets the direction of this
Vector2
.
- setDirection(Vector2) - Method in class org.dyn4j.geometry.Ray
-
Sets the direction.
- setDistance(double) - Method in class org.dyn4j.collision.narrowphase.Raycast
-
Sets the distance from the start of the
Ray
to the hit point.
- setDistance(double) - Method in class org.dyn4j.collision.narrowphase.Separation
-
Sets the separation distance.
- setDistance(double) - Method in class org.dyn4j.dynamics.joint.DistanceJoint
-
Sets the rest distance between the two constrained
Body
s in meters.
- setDistanceDetector(DistanceDetector) - Method in class org.dyn4j.collision.continuous.ConservativeAdvancement
-
- setDistanceEpsilon(double) - Method in class org.dyn4j.collision.continuous.ConservativeAdvancement
-
Sets the distance epsilon used to determine when a sufficient solution
has been found.
- setDistanceEpsilon(double) - Method in class org.dyn4j.collision.narrowphase.Epa
-
The minimum distance between two iterations of the algorithm.
- setDistanceEpsilon(double) - Method in class org.dyn4j.collision.narrowphase.Gjk
-
The minimum distance between two iterations of the
Gjk
distance algorithm.
- setEnabled(boolean) - Method in class org.dyn4j.dynamics.contact.ContactConstraint
-
Sets the enabled flag.
- setFilter(Filter) - Method in class org.dyn4j.collision.Fixture
-
Sets the collision filter for this fixture.
- setFixture(BodyFixture) - Method in class org.dyn4j.dynamics.ConvexCastResult
-
Sets the fixture with the smallest time of impact.
- setFixture(BodyFixture) - Method in class org.dyn4j.dynamics.DetectResult
-
Sets the overlapping fixture.
- setFixture(BodyFixture) - Method in class org.dyn4j.dynamics.RaycastResult
-
- setFrequency(double) - Method in class org.dyn4j.dynamics.joint.DistanceJoint
-
Sets the spring frequency.
- setFrequency(double) - Method in class org.dyn4j.dynamics.joint.PinJoint
-
Sets the spring frequency.
- setFrequency(double) - Method in class org.dyn4j.dynamics.joint.WeldJoint
-
Sets the spring frequency.
- setFrequency(double) - Method in class org.dyn4j.dynamics.joint.WheelJoint
-
Sets the spring frequency.
- setFriction(double) - Method in class org.dyn4j.dynamics.BodyFixture
-
Sets the coefficient of friction.
- setFriction(double) - Method in class org.dyn4j.dynamics.contact.ContactConstraint
-
Sets the coefficient of friction for this contact constraint.
- setGravity(Vector2) - Method in class org.dyn4j.dynamics.World
-
Sets the acceleration due to gravity.
- setGravityScale(double) - Method in class org.dyn4j.dynamics.Body
-
Sets the gravity scale.
- setLength(double) - Method in class org.dyn4j.dynamics.joint.PulleyJoint
-
Sets the total length of the pulley "rope."
- setLimitEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets whether the angle limits are enabled.
- setLimitEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Enables or disables the limits.
- setLimitEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
Enables or disables the rotational limit.
- setLimits(double) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets both the lower and upper limits to the given limit.
- setLimits(double) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Sets both the lower and upper limits to the given limit.
- setLimits(double, double) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets both the lower and upper limits.
- setLimits(double, double) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Sets the upper and lower limits.
- setLimits(double, double) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
Sets the upper and lower rotational limits.
- setLimits(double, double) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Sets both the lower and upper limits.
- setLimitsEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Enables or disables both the lower and upper limits.
- setLimitsEnabled(double) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets both the lower and upper limits to the given limit and enables them.
- setLimitsEnabled(double) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Sets both the lower and upper limits to the given limit and
enables both.
- setLimitsEnabled(double, double) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets both the lower and upper limits and enables them.
- setLimitsEnabled(double, double) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Sets the upper and lower limits and enables the limits.
- setLimitsEnabled(double, double) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Sets both the lower and upper limits and enables both.
- setLinearDamping(double) - Method in class org.dyn4j.dynamics.Body
-
Sets the linear damping.
- setLinearTarget(Vector2) - Method in class org.dyn4j.dynamics.joint.MotorJoint
-
Sets the desired linear distance along the x and y coordinates from
body1's world center.
- setLinearTolerance(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the linear tolerance.
- setLinearVelocity(double, double) - Method in class org.dyn4j.dynamics.Body
-
Sets the linear velocity.
- setLinearVelocity(Vector2) - Method in class org.dyn4j.dynamics.Body
-
Sets the linear velocity.
- setLowerLimit(double) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets the lower limit in radians.
- setLowerLimit(double) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Sets the lower limit.
- setLowerLimit(double) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
Sets the lower rotational limit.
- setLowerLimit(double) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Sets the lower limit in meters.
- setLowerLimitEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Sets whether the lower limit is enabled.
- setMagnitude(double) - Method in class org.dyn4j.geometry.Vector2
-
- setMagnitude(double) - Method in class org.dyn4j.geometry.Vector3
-
- setManifoldSolver(ManifoldSolver) - Method in class org.dyn4j.dynamics.World
-
Sets the manifold solver.
- setMass() - Method in class org.dyn4j.dynamics.Body
-
- setMass(Mass) - Method in class org.dyn4j.dynamics.Body
-
Explicitly sets this
Body
's mass information.
- setMass(MassType) - Method in class org.dyn4j.dynamics.Body
-
This method should be called after fixture modification
is complete.
- setMassType(MassType) - Method in class org.dyn4j.dynamics.Body
-
- setMax(double) - Method in class org.dyn4j.geometry.Interval
-
Sets the maximum for this interval.
- setMaxDetectIterations(int) - Method in class org.dyn4j.collision.narrowphase.Gjk
-
Sets the maximum number of iterations the
Gjk
collision detection algorithm will perform when
before return that two convex shapes are not overlapping.
- setMaxDistanceIterations(int) - Method in class org.dyn4j.collision.narrowphase.Gjk
-
Sets the maximum number of iterations the
Gjk
distance algorithm will perform when
determining the distance between two convex shapes.
- setMaximumAngularCorrection(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the maximum angular correction.
- setMaximumForce(double) - Method in class org.dyn4j.dynamics.joint.FrictionJoint
-
Sets the maximum force this constraint will apply in newtons.
- setMaximumForce(double) - Method in class org.dyn4j.dynamics.joint.MotorJoint
-
Sets the maximum force this constraint will apply in newtons.
- setMaximumForce(double) - Method in class org.dyn4j.dynamics.joint.PinJoint
-
Sets the maximum force this constraint will apply in newtons.
- setMaximumLinearCorrection(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the maximum linear correction.
- setMaximumMotorForce(double) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Sets the maximum force the motor can apply to the joint
to achieve the target speed.
- setMaximumMotorTorque(double) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
Sets the maximum torque this motor will apply in newton-meters.
- setMaximumMotorTorque(double) - Method in class org.dyn4j.dynamics.joint.WheelJoint
-
Sets the maximum torque the motor can apply to the joint
to achieve the target speed.
- setMaximumRotation(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the maximum rotation a
Body
can have in one time step.
- setMaximumTorque(double) - Method in class org.dyn4j.dynamics.joint.FrictionJoint
-
Sets the maximum torque this constraint will apply in newton-meters.
- setMaximumTorque(double) - Method in class org.dyn4j.dynamics.joint.MotorJoint
-
Sets the maximum torque this constraint will apply in newton-meters.
- setMaximumTranslation(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the maximum translation a
Body
can have in one time step.
- setMaxIterations(int) - Method in class org.dyn4j.collision.continuous.ConservativeAdvancement
-
Sets the maximum number of iterations that will be
performed by the root finder.
- setMaxIterations(int) - Method in class org.dyn4j.collision.narrowphase.Epa
-
Sets the maximum number of iterations the algorithm will perform before exiting.
- setMaxIterations(int) - Method in class org.dyn4j.collision.narrowphase.Gjk
-
- setMaxRaycastIterations(int) - Method in class org.dyn4j.collision.narrowphase.Gjk
-
Sets the maximum number of iterations the
Gjk
raycast algorithm will perform when
checking whether the ray intersects the convex.
- setMin(double) - Method in class org.dyn4j.geometry.Interval
-
Sets the minimum for this interval.
- setMinkowskiPenetrationSolver(MinkowskiPenetrationSolver) - Method in class org.dyn4j.collision.narrowphase.Gjk
-
- setMotorEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Enables or disables the motor.
- setMotorEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
Sets whether the motor for this joint is enabled or not.
- setMotorEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.WheelJoint
-
Enables or disables the motor.
- setMotorSpeed(double) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Sets the target motor speed.
- setMotorSpeed(double) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
Sets the target motor speed in radians/second.
- setMotorSpeed(double) - Method in class org.dyn4j.dynamics.joint.WheelJoint
-
Sets the target motor speed.
- setNarrowphaseDetector(NarrowphaseDetector) - Method in class org.dyn4j.dynamics.World
-
Sets the narrow-phase collision detection algorithm.
- setNext(Link) - Method in class org.dyn4j.geometry.Link
-
Sets the next link in the chain.
- setNormal(Vector2) - Method in class org.dyn4j.collision.manifold.Manifold
-
Sets the manifold normal.
- setNormal(Vector2) - Method in class org.dyn4j.collision.narrowphase.Penetration
-
Sets the penetration normal.
- setNormal(Vector2) - Method in class org.dyn4j.collision.narrowphase.Raycast
-
Sets the normal at the hit point.
- setNormal(Vector2) - Method in class org.dyn4j.collision.narrowphase.Separation
-
Sets the separation normal.
- setPenetration(Penetration) - Method in class org.dyn4j.dynamics.DetectResult
-
Sets the overlap penetration (collision data).
- setPoint(Vector2) - Method in class org.dyn4j.collision.manifold.ManifoldPoint
-
Sets the contact point.
- setPoint(Vector2) - Method in class org.dyn4j.collision.narrowphase.Raycast
-
Sets the hit point.
- setPoint1(Vector2) - Method in class org.dyn4j.collision.narrowphase.Separation
-
- setPoint2(Vector2) - Method in class org.dyn4j.collision.narrowphase.Separation
-
- setPoints(List<ManifoldPoint>) - Method in class org.dyn4j.collision.manifold.Manifold
-
- setPositionConstraintSolverIterations(int) - Method in class org.dyn4j.dynamics.Settings
-
Sets the number of iterations used to solve position constraints.
- setPrevious(Link) - Method in class org.dyn4j.geometry.Link
-
Sets the previous link in the chain.
- setRatio(double) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets the angular velocity ratio between the two bodies.
- setRatio(double) - Method in class org.dyn4j.dynamics.joint.PulleyJoint
-
Sets the pulley ratio.
- setRaycast(Raycast) - Method in class org.dyn4j.dynamics.RaycastResult
-
Sets the
Raycast
result information.
- setRaycastDetector(RaycastDetector) - Method in class org.dyn4j.dynamics.World
-
Sets the raycast detector.
- setRaycastEpsilon(double) - Method in class org.dyn4j.collision.narrowphase.Gjk
-
The minimum distance between the ray and convex for the
Gjk
raycast algorithm.
- setReferenceAngle(double) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets the reference angle.
- setReferenceAngle(double) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Sets the reference angle.
- setReferenceAngle(double) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
Sets the reference angle.
- setReferenceAngle(double) - Method in class org.dyn4j.dynamics.joint.WeldJoint
-
Sets the reference angle.
- setRestitution(double) - Method in class org.dyn4j.dynamics.BodyFixture
-
Sets the coefficient of restitution.
- setRestitution(double) - Method in class org.dyn4j.dynamics.contact.ContactConstraint
-
Sets the coefficient of restitution for this contact constraint.
- setRestitutionVelocity(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the restitution velocity.
- setRotation(double) - Method in class org.dyn4j.geometry.Transform
-
Sets the rotation and returns the previous
rotation.
- setSelfBalancing(boolean) - Method in class org.dyn4j.BinarySearchTree
-
Sets whether this tree should self balance.
- setSensor(boolean) - Method in class org.dyn4j.collision.Fixture
-
Toggles this fixture as a sensor fixture.
- setSensor(boolean) - Method in class org.dyn4j.dynamics.contact.ContactConstraint
-
Sets this contact constraint to a sensor if flag is true.
- setSeparation(Separation) - Method in class org.dyn4j.collision.continuous.TimeOfImpact
-
Sets the separation at the time of impact.
- setSettings(Settings) - Method in class org.dyn4j.dynamics.World
-
Sets the dynamics settings for this world.
- setSlackEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.PulleyJoint
-
Toggles the slack in the rope.
- setSleepAngularVelocity(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the sleep angular velocity.
- setSleepLinearVelocity(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the sleep linear velocity.
- setSleepTime(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the sleep time.
- setStart(Vector2) - Method in class org.dyn4j.geometry.Ray
-
Sets the start point.
- setStepFrequency(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the step frequency of the dynamics engine.
- setTangentSpeed(double) - Method in class org.dyn4j.dynamics.contact.ContactConstraint
-
Sets the target surface speed of the contact constraint.
- setTarget(Vector2) - Method in class org.dyn4j.dynamics.joint.PinJoint
-
Returns the target point in world coordinates.
- setTime(double) - Method in class org.dyn4j.collision.continuous.TimeOfImpact
-
Sets the time of impact.
- setTimeOfImpact(TimeOfImpact) - Method in class org.dyn4j.dynamics.ConvexCastResult
-
Sets the time of impact information.
- setTimeOfImpactDetector(TimeOfImpactDetector) - Method in class org.dyn4j.dynamics.World
-
Sets the time of impact detector.
- Settings - Class in org.dyn4j.dynamics
-
Responsible for housing all of the dynamics engine's settings.
- Settings() - Constructor for class org.dyn4j.dynamics.Settings
-
Default constructor
- setTransform(Transform) - Method in class org.dyn4j.collision.AbstractCollidable
-
- setTransform(Transform) - Method in interface org.dyn4j.collision.Collidable
-
- setTranslation(double, double) - Method in class org.dyn4j.geometry.Transform
-
Sets the translation.
- setTranslation(Vector2) - Method in class org.dyn4j.geometry.Transform
-
Sets the translation.
- setTranslationX(double) - Method in class org.dyn4j.geometry.Transform
-
Sets the translation along the x axis.
- setTranslationY(double) - Method in class org.dyn4j.geometry.Transform
-
Sets the translation along the y axis.
- setType(MassType) - Method in class org.dyn4j.geometry.Mass
-
Sets the mass type.
- setUpdateRequired(boolean) - Method in class org.dyn4j.dynamics.World
-
Sets the update required flag.
- setUpperLimit(double) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
Sets the upper limit in radians.
- setUpperLimit(double) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
Sets the upper limit.
- setUpperLimit(double) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
Sets the upper rotational limit.
- setUpperLimit(double) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Sets the upper limit in meters.
- setUpperLimitEnabled(boolean) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
Sets whether the upper limit is enabled.
- setUserData(Object) - Method in class org.dyn4j.collision.AbstractCollidable
-
- setUserData(Object) - Method in class org.dyn4j.collision.Fixture
-
- setUserData(Object) - Method in interface org.dyn4j.DataContainer
-
Sets the custom user data to the given data.
- setUserData(Object) - Method in class org.dyn4j.dynamics.joint.Joint
-
- setUserData(Object) - Method in class org.dyn4j.dynamics.World
-
- setUserData(Object) - Method in class org.dyn4j.geometry.AbstractShape
-
- setVelocityConstraintSolverIterations(int) - Method in class org.dyn4j.dynamics.Settings
-
Sets the number of iterations used to solve velocity constraints.
- setWarmStartDistance(double) - Method in class org.dyn4j.dynamics.Settings
-
Sets the warm start distance.
- setWarmStartingEnabled(boolean) - Method in class org.dyn4j.dynamics.contact.DefaultContactManager
-
Toggles warm starting.
- Shape - Interface in org.dyn4j.geometry
-
Represents a geometric
Shape
.
- shift(Vector2) - Method in class org.dyn4j.collision.AbstractBounds
-
- shift(Vector2) - Method in class org.dyn4j.collision.AbstractCollidable
-
- shift(Vector2) - Method in class org.dyn4j.collision.broadphase.DynamicAABBTree
-
- shift(Vector2) - Method in class org.dyn4j.collision.broadphase.Sap
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.contact.ContactConstraint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.contact.DefaultContactManager
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.DistanceJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.FrictionJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.MotorJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.PinJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.PulleyJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.WeldJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.joint.WheelJoint
-
- shift(Vector2) - Method in class org.dyn4j.dynamics.World
-
Shifts the coordinates of the entire world by the given amount.
- shift(Vector2) - Method in interface org.dyn4j.geometry.Shiftable
-
Translates the object to match the given coordinate shift.
- Shiftable - Interface in org.dyn4j.geometry
-
Represents an object that can be shifted in the x and y plane.
- SimpleContactManager - Class in org.dyn4j.dynamics.contact
-
- SimpleContactManager() - Constructor for class org.dyn4j.dynamics.contact.SimpleContactManager
-
Deprecated.
Default constructor.
- SimpleContactManager(Capacity) - Constructor for class org.dyn4j.dynamics.contact.SimpleContactManager
-
Deprecated.
Full constructor.
- SingleTypedFallbackCondition - Class in org.dyn4j.collision.narrowphase
-
- SingleTypedFallbackCondition(Class<? extends Convex>) - Constructor for class org.dyn4j.collision.narrowphase.SingleTypedFallbackCondition
-
Minimal constructor.
- SingleTypedFallbackCondition(Class<? extends Convex>, boolean) - Constructor for class org.dyn4j.collision.narrowphase.SingleTypedFallbackCondition
-
Optional constructor.
- SingleTypedFallbackCondition(Class<? extends Convex>, int) - Constructor for class org.dyn4j.collision.narrowphase.SingleTypedFallbackCondition
-
Optional constructor.
- SingleTypedFallbackCondition(Class<? extends Convex>, int, boolean) - Constructor for class org.dyn4j.collision.narrowphase.SingleTypedFallbackCondition
-
Full constructor.
- size() - Method in class org.dyn4j.BinarySearchTree
-
Returns the number of elements in the tree.
- size() - Method in interface org.dyn4j.collision.broadphase.BroadphaseDetector
-
Returns the number of
Fixture
s that are being managed in this broad-phase.
- size() - Method in class org.dyn4j.collision.broadphase.DynamicAABBTree
-
- size() - Method in class org.dyn4j.collision.broadphase.Sap
-
- Slice - Class in org.dyn4j.geometry
-
- Slice(double, double) - Constructor for class org.dyn4j.geometry.Slice
-
Full constructor.
- SLUG_TO_KILOGRAM - Static variable in class org.dyn4j.UnitConversion
-
- slugsToKilograms(double) - Static method in class org.dyn4j.UnitConversion
-
Converts slugs to kilograms.
- solve(Body, Body, TimeOfImpact, Settings) - Method in class org.dyn4j.dynamics.contact.TimeOfImpactSolver
-
- solve(Vector2) - Method in class org.dyn4j.geometry.Matrix22
-
Solves the system of linear equations:
- solve22(Vector2) - Method in class org.dyn4j.geometry.Matrix33
-
Solves the system of linear equations:
- solve33(Vector3) - Method in class org.dyn4j.geometry.Matrix33
-
Solves the system of linear equations:
- SolvedContactPoint - Class in org.dyn4j.dynamics.contact
-
Represents a solved contact point.
- SolvedContactPoint(ContactConstraint, Contact) - Constructor for class org.dyn4j.dynamics.contact.SolvedContactPoint
-
Helper constructor for a contact constraint and contact.
- SolvedContactPoint(ContactPointId, Body, BodyFixture, Body, BodyFixture, Vector2, Vector2, double, double, double) - Constructor for class org.dyn4j.dynamics.contact.SolvedContactPoint
-
Full constructor.
- SolvedContactPoint(SolvedContactPoint) - Constructor for class org.dyn4j.dynamics.contact.SolvedContactPoint
-
Copy constructor (shallow).
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.DistanceJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.FrictionJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.Joint
-
Solves the position constraints.
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.MotorJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.PinJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.PulleyJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.WeldJoint
-
- solvePositionConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.WheelJoint
-
- solvePositionContraints(List<ContactConstraint>, Step, Settings) - Method in interface org.dyn4j.dynamics.contact.ContactConstraintSolver
-
- solvePositionContraints(List<ContactConstraint>, Step, Settings) - Method in class org.dyn4j.dynamics.contact.SequentialImpulses
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.AngleJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.DistanceJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.FrictionJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.Joint
-
Solves the velocity constraints.
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.MotorJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.PinJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.PrismaticJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.PulleyJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.RevoluteJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.RopeJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.WeldJoint
-
- solveVelocityConstraints(Step, Settings) - Method in class org.dyn4j.dynamics.joint.WheelJoint
-
- solveVelocityContraints(List<ContactConstraint>, Step, Settings) - Method in interface org.dyn4j.dynamics.contact.ContactConstraintSolver
-
- solveVelocityContraints(List<ContactConstraint>, Step, Settings) - Method in class org.dyn4j.dynamics.contact.SequentialImpulses
-
- step(int) - Method in class org.dyn4j.dynamics.World
-
Performs the given number of simulation steps using the step frequency in
Settings
.
- step(int, double) - Method in class org.dyn4j.dynamics.World
-
Performs the given number of simulation steps using the given elapsed time for each step.
- Step - Class in org.dyn4j.dynamics
-
Class encapsulating the timestep information.
- Step(double) - Constructor for class org.dyn4j.dynamics.Step
-
Default constructor.
- StepAdapter - Class in org.dyn4j.dynamics
-
Convenience class for implementing the
StepListener
interface.
- StepAdapter() - Constructor for class org.dyn4j.dynamics.StepAdapter
-
- StepListener - Interface in org.dyn4j.dynamics
-
Listener notified before and after a simulation step by the
World
.
- subsetIterator(E, E) - Method in class org.dyn4j.BinarySearchTree
-
Returns the in-order (ascending) iterator.
- subtract(double, double) - Method in class org.dyn4j.geometry.Vector2
-
- subtract(double, double, double) - Method in class org.dyn4j.geometry.Vector3
-
- subtract(Matrix22) - Method in class org.dyn4j.geometry.Matrix22
-
- subtract(Matrix33) - Method in class org.dyn4j.geometry.Matrix33
-
- subtract(Vector2) - Method in class org.dyn4j.geometry.Vector2
-
- subtract(Vector3) - Method in class org.dyn4j.geometry.Vector3
-
- sum(double, double) - Method in class org.dyn4j.geometry.Vector2
-
- sum(double, double, double) - Method in class org.dyn4j.geometry.Vector3
-
- sum(Matrix22) - Method in class org.dyn4j.geometry.Matrix22
-
- sum(Matrix33) - Method in class org.dyn4j.geometry.Matrix33
-
- sum(Vector2) - Method in class org.dyn4j.geometry.Vector2
-
- sum(Vector3) - Method in class org.dyn4j.geometry.Vector3
-
- SweepLine - Class in org.dyn4j.geometry.decompose
-
Implementation of the Sweep convex decomposition algorithm for simple polygons.
- SweepLine() - Constructor for class org.dyn4j.geometry.decompose.SweepLine
-