Index

A B C D E F G H I J K L M N O P Q R S T U V W X Y Z 
All Classes and Interfaces|All Packages|Constant Field Values|Serialized Form

A

A - Enum constant in enum class com.jme3.bullet.joints.JointEnd
the first end
aabbCenter(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Return the center of the shape's axis-aligned bounding box in local coordinates.
aabbVolume() - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Calculate a quick upper bound for the unscaled volume of the hull, based on its axis-aligned bounding box.
abs(float) - Static method in class com.jme3.math.FastMath
Returns Absolute value of a float.
accelerate(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Apply the specified engine force to each wheel.
accelerate(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Apply the specified engine force to the indexed wheel.
accumulateMaxima(Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVector3f
Accumulate maximum coordinates.
accumulateMinima(Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVector3f
Accumulate minimum coordinates.
accumulateScaled(Quaternion, Quaternion, float) - Static method in class jme3utilities.math.MyQuaternion
Accumulate a linear combination of quaternions.
accumulateScaled(Vector3f, Vector3f, float) - Static method in class jme3utilities.math.MyVector3f
Accumulate a linear combination of vectors.
ACDMode - Enum Class in vhacd
Enumerate the legal values for the m_mode field of IVHACD::Parameters.
activate() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Reactivate the body if it has been deactivated due to lack of motion.
activate(boolean) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Reactivate the collision object if it has been deactivated due to lack of motion.
activateAll(boolean) - Method in class com.jme3.bullet.MultiBodySpace
Activate all colliders and rigid bodies in this space.
activateAll(boolean) - Method in class com.jme3.bullet.PhysicsSpace
Activate all rigid bodies in the space.
Activation - Class in com.jme3.bullet.collision
Named activation states for use with a PhysicsCollisionObject.
active - Static variable in class com.jme3.bullet.collision.Activation
an active collision object that's subject to deactivation when its timer runs out (native name: ACTIVE_TAG)
add(double, double, double) - Method in class com.simsilica.mathd.Vec3d
Adds specified amounts to the vector's components and returns the sum as a new instance.
add(float, float, float) - Method in class com.jme3.math.Vector3f
Adds specified amounts to the vector's components and returns the sum as a new instance.
add(float, float, float) - Method in interface jme3utilities.math.VectorSet
Add the specified value to this set, if it's not already present.
add(float, float, float) - Method in class jme3utilities.math.VectorSetUsingBuffer
Add the specified value to this set, if it's not already present.
add(IndexedMesh) - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Add a submesh to this mesh.
add(Vector3f) - Method in class com.jme3.math.Vector3f
Adds the argument and returns the sum as a new instance.
add(Vector3f) - Method in interface jme3utilities.math.VectorSet
Add the value of the specified Vector3f to this set, if it's not already present.
add(Vector3f) - Method in class jme3utilities.math.VectorSetUsingBuffer
Add the value of the specified Vector3f to this set, if it's not already present.
add(Vector3f, Vector3f) - Method in class com.jme3.math.Vector3f
Adds a specified vector and returns the sum in a 3rd vector.
add(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Adds the argument and returns the sum as a new instance.
add(Object) - Method in class com.jme3.bullet.CollisionSpace
Add the specified object to the space.
add(Object) - Method in class com.jme3.bullet.MultiBodySpace
Add the specified object to this space.
add(Object) - Method in class com.jme3.bullet.PhysicsSpace
Add the specified object to the space.
addAll(Iterable<Vector3f>) - Method in interface jme3utilities.math.VectorSet
Add the specified values to this set, to the extent that they're not already present.
addAll(Iterable<Vector3f>) - Method in class jme3utilities.math.VectorSetUsingBuffer
Add the specified values to this set, to the extent that they're not already present.
addBaseCollider(CollisionShape) - Method in class com.jme3.bullet.MultiBody
Add a collider for the base.
addBaseForce(Vector3f) - Method in class com.jme3.bullet.MultiBody
Add an external force to the base.
addBaseTorque(Vector3f) - Method in class com.jme3.bullet.MultiBody
Add an external torque to the base.
addChildShape(CollisionShape) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Add a child shape without transforming its coordinates.
addChildShape(CollisionShape, float, float, float) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Add a child shape with the specified local translation.
addChildShape(CollisionShape, Transform) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Add a child shape with the specified local transform.
addChildShape(CollisionShape, Vector3f) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Add a child shape with the specified local translation.
addChildShape(CollisionShape, Vector3f, Matrix3f) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Add a child shape with the specified local translation and orientation.
addCollider(CollisionShape) - Method in class com.jme3.bullet.MultiBodyLink
Add a collider for this link.
addCollideWithGroup(int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Add collision groups to the set with which this object can collide.
addCollisionObject(PhysicsCollisionObject) - Method in class com.jme3.bullet.CollisionSpace
Add the specified collision object to the space.
addCollisionObject(PhysicsCollisionObject) - Method in class com.jme3.bullet.DeformableSpace
Add the specified collision object to this space.
addCollisionObject(PhysicsCollisionObject) - Method in class com.jme3.bullet.PhysicsSoftSpace
Add the specified collision object to this space.
addCollisionObject(PhysicsCollisionObject) - Method in class com.jme3.bullet.PhysicsSpace
Add the specified collision object to the space.
addConstraintForce(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Add an external force to this link.
addConstraintTorque(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Add an external torque to this link.
addDescription(String) - Method in class jme3utilities.debug.Dumper
If the specified description is non-empty, print it to the stream, prefixed by a blank.
addForce(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Add an external force to this link.
addJoint(PhysicsJoint) - Method in class com.jme3.bullet.objects.PhysicsBody
Do not invoke directly! Joints are added automatically when created.
addJoint(PhysicsJoint) - Method in class com.jme3.bullet.PhysicsSpace
Add the specified PhysicsJoint to the space.
addJointTorque(int, float) - Method in class com.jme3.bullet.MultiBodyLink
Add an external torque to this link's joint.
addLine(String) - Method in class jme3utilities.debug.Dumper
Print a newline, followed by the specified indentation.
addLocal(double, double, double) - Method in class com.simsilica.mathd.Vec3d
Adds specified amounts to the vector's components and returns the (modified) current instance.
addLocal(float, float, float) - Method in class com.jme3.math.Vector3f
Adds specified amounts to the vector's components and returns the (modified) current instance.
addLocal(Quaternion) - Method in class com.jme3.math.Quaternion
Adds the argument and returns the (modified) current instance.
addLocal(Vector3f) - Method in class com.jme3.math.Vector3f
Adds the argument and returns the (modified) current instance.
addLocal(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Adds the argument and returns the (modified) current instance.
addMultiBody(MultiBody) - Method in class com.jme3.bullet.MultiBodySpace
Add the specified MultiBody and all its colliders.
addProgressListener(VHACDProgressListener) - Static method in class vhacd.VHACD
Register the specified progress listener.
addProgressListener(VHACDProgressListener) - Static method in class vhacd4.Vhacd4
Register the specified progress listener.
addTickListener(PhysicsTickListener) - Method in class com.jme3.bullet.PhysicsSpace
Register the specified tick listener with the space.
addToIgnoreList(PhysicsCollisionObject) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Add another collision object to this object's ignore list and vice versa.
addTorque(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Add an external torque to this link.
addVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Add velocity to this entire body.
addVelocity(Vector3f, int) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Add velocity to the indexed node of this body.
addWheel(VehicleWheel, VehicleTuning) - Method in class com.jme3.bullet.objects.infos.VehicleController
Add a wheel to this controller.
addWheel(Vector3f, Vector3f, Vector3f, float, float, boolean) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Add a wheel to this vehicle.
Aero - Enum Class in com.jme3.bullet.objects.infos
Enumerate the implemented aerodynamic models for a SoftBodyConfig.
aerodynamics() - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Return the aerodynamics model.
AfMode - Class in com.jme3.bullet.collision
Named anisotropic friction modes for use with a PhysicsCollisionObject.
airDensity() - Method in class com.jme3.bullet.SoftBodyWorldInfo
Return the air density.
allocate(int) - Method in interface com.jme3.util.BufferAllocator
Allocate a direct ByteBuffer of the specified size.
allocate(int) - Method in class com.jme3.util.PrimitiveAllocator
Allocate a direct ByteBuffer of the specified size.
AllowZeroLength - Static variable in class com.jme3.bullet.SolverMode
allow zero-length friction directions
Anchor - Class in com.jme3.bullet.joints
A PhysicsJoint to join a particular node of a soft body (A) to a rigid body (B), based on Bullet's btSoftBody::Anchor.
Anchor(PhysicsSoftBody, int, PhysicsRigidBody, Vector3f, boolean) - Constructor for class com.jme3.bullet.joints.Anchor
Instantiate an anchor with influence=1.
AnchorHardness - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
anchor hardness coefficient (≥0, ≤1, default=0.7, native field: kAHR)
Android - Enum constant in enum class com.jme3.system.Platform.Os
Android operating systems
Android_ARM5 - Enum constant in enum class com.jme3.system.Platform
Android ARM5
Android_ARM6 - Enum constant in enum class com.jme3.system.Platform
Android ARM6
Android_ARM7 - Enum constant in enum class com.jme3.system.Platform
Android ARM7
Android_ARM8 - Enum constant in enum class com.jme3.system.Platform
Android ARM8
Android_Other - Enum constant in enum class com.jme3.system.Platform
Android running on unknown platform (could be x86 or mips for example).
Android_X86 - Enum constant in enum class com.jme3.system.Platform
Android x86
angularDamping() - Method in class com.jme3.bullet.MultiBody
Determine the angular damping.
AngularDamping - Enum constant in enum class com.jme3.bullet.objects.infos.Cluster
angular damping coefficient (default=0, native field: m_adamping)
angularStiffness() - Method in class com.jme3.bullet.objects.infos.SoftBodyMaterial
Read the angular-stiffness coefficient (native field: m_kAST).
appendFaces(IndexBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Append faces to this body.
appendFromLineMesh(Mesh, PhysicsSoftBody) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Append the edges in the specified line-mode Mesh to the specified soft body.
appendFromNativeMesh(IndexedMesh, PhysicsSoftBody) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Add the triangles and unique edges in the specified native mesh to the specified soft body.
appendFromTriMesh(Mesh, PhysicsSoftBody) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Add the triangles and unique edges in the specified LBJ mesh to the specified soft body.
appendLinks(IndexBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Append links to this body.
appendNodes(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Append nodes to this body, each with mass=1.
appendTetras(PhysicsSoftBody) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Append tetrahedra to the specified soft body, one per face, connecting its faces with the center of its axis-aligned bounding box.
appendTetras(IndexBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Append tetrahedra to this body.
appliedForce(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the net applied force on this link.
appliedTorque(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the net applied torque on this link.
applyAllExceptIgnoreListTo(PhysicsRigidBody) - Method in class com.jme3.bullet.objects.infos.RigidBodySnapshot
Apply all properties (except the ignore list) to the specified body.
applyCentralForce(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Apply a force to the body's center of mass.
applyCentralImpulse(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Apply an impulse to the body's center of mass.
applyEngineForce(VehicleWheel, float) - Method in class com.jme3.bullet.objects.infos.VehicleController
Apply the specified engine force to the specified wheel.
applyForce(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Apply a force that acts uniformly across the entire body.
applyForce(Vector3f, int) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Apply a force to the indexed node of this body.
applyForce(Vector3f, Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Apply a force to the body.
applyImpulse(Vector3f, Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Apply an off-center impulse to the body.
applyRotation(Quaternion) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Rotate this body.
applyScale(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Scale this body.
applyTo(PhysicsRigidBody) - Method in class com.jme3.bullet.objects.infos.RigidBodySnapshot
Apply the properties to the specified body.
applyTorque(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Apply a torque to the body.
applyTorqueImpulse(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Apply a torque impulse to the body.
applyTransform(Transform) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Transform this body.
applyTranslation(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Translate this body.
approximateEquals(float, float) - Static method in class com.jme3.math.FastMath
Determine if two floats are approximately equal.
aRadius() - Method in class com.jme3.bullet.collision.shapes.ConicalFrustum
Return the radius of the "A" base.
area(Triangle) - Static method in class jme3utilities.math.MyMath
Return the (one-sided) area of the specified triangle.
ArticulatedWarmStart - Static variable in class com.jme3.bullet.SolverMode
use articulated warm start
atan(float) - Static method in class com.jme3.math.FastMath
Returns the arc tangent of an angle given in radians.
atan2(float, float) - Static method in class com.jme3.math.FastMath
A direct call to Math.atan2.
attachCollisionShape(long, long) - Static method in class com.jme3.bullet.collision.PhysicsCollisionObject
Attach the identified btCollisionShape to the identified btCollisionObject.
attachShape(CollisionShape) - Method in class com.jme3.bullet.objects.MultiBodyCollider
Attach the specified collision shape to this collider.
axis(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the direction of the joint's axis for a planar, prismatic, or revolute joint.
AXIS_SWEEP_3 - Enum constant in enum class com.jme3.bullet.PhysicsSpace.BroadphaseType
btAxisSweep3: incremental 3-D sweep and prune, requires world bounds, limited to 16_384 physics objects
AXIS_SWEEP_3_32 - Enum constant in enum class com.jme3.bullet.PhysicsSpace.BroadphaseType
bt32BitAxisSweep3: incremental 3-D sweep and prune, requires world bounds, limited to 1_500_000 physics objects
AXIS_X - Static variable in class com.jme3.bullet.PhysicsSpace
index of the X axis
AXIS_Y - Static variable in class com.jme3.bullet.PhysicsSpace
index of the Y axis
AXIS_Z - Static variable in class com.jme3.bullet.PhysicsSpace
index of the Z axis
axisIndex(int, String) - Static method in class jme3utilities.Validate
Validate an axis index as a method argument.
axisName(int) - Static method in class jme3utilities.MyString
Describe a coordinate axis.

B

B - Enum constant in enum class com.jme3.bullet.joints.JointEnd
the 2nd end
baseAngularVelocity(Vector3f) - Method in class com.jme3.bullet.MultiBody
Determine the angular velocity of the base.
baseForce(Vector3f) - Method in class com.jme3.bullet.MultiBody
Determine the net force on the base.
baseInertia(Vector3f) - Method in class com.jme3.bullet.MultiBody
Determine the rotational inertia of the base.
baseLocation(Vector3f) - Method in class com.jme3.bullet.MultiBody
Determine the location of the base's center of mass.
baseMass() - Method in class com.jme3.bullet.MultiBody
Determine the mass of the base.
baseOrientation(Quaternion) - Method in class com.jme3.bullet.MultiBody
Determine the orientation of the base.
baseTorque(Vector3f) - Method in class com.jme3.bullet.MultiBody
Determine the net torque on the base.
baseTransform(Transform) - Method in class com.jme3.bullet.MultiBody
Determine the transform of the base.
baseVelocity(Vector3f) - Method in class com.jme3.bullet.MultiBody
Determine the linear velocity of the base's center of mass.
basic - Static variable in class com.jme3.bullet.collision.AfMode
basic anisotropic friction mode (native name: CF_ANISOTROPIC_FRICTION)
Bounce - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
restitution/bounce factor at the limits (m_bounce, default=0)
boundingBox(BoundingBox) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Calculate an axis-aligned bounding box for this object, based on its collision shape.
boundingBox(BoundingBox) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Calculate the axis-aligned bounding box for this body.
boundingBox(Vector3f, Matrix3f, BoundingBox) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Calculate an axis-aligned bounding box with the specified translation and rotation applied.
boundingBox(Vector3f, Quaternion, BoundingBox) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Calculate an axis-aligned bounding box with the specified translation and rotation applied.
BoundingBox - Class in com.jme3.bounding
BoundingBox describes a bounding volume as an axis-aligned box.
BoundingBox() - Constructor for class com.jme3.bounding.BoundingBox
Instantiate a BoundingBox without initializing it.
BoundingBox(Vector3f, float, float, float) - Constructor for class com.jme3.bounding.BoundingBox
Instantiate a BoundingBox with given center and extents.
BoundingBox(Vector3f, Vector3f) - Constructor for class com.jme3.bounding.BoundingBox
Instantiate a BoundingBox with the specified extremes.
BoundingValueHierarchy - Class in com.jme3.bullet.collision.shapes.infos
A Bounding-Value Hierarchy (BVH) generated for a MeshCollisionShape, based on Bullet's btOptimizedBvh.
BoundingValueHierarchy(byte[]) - Constructor for class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Instantiate a (tracked) hierarchy from serialized bytes.
BoundingValueHierarchy(MeshCollisionShape) - Constructor for class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Instantiate an (untracked) reference to the hierarchy of the specified MeshCollisionShape.
Box2dShape - Class in com.jme3.bullet.collision.shapes
An axis-aligned, rectangular collision shape based on Bullet's btBox2dShape.
Box2dShape(float) - Constructor for class com.jme3.bullet.collision.shapes.Box2dShape
Instantiate a square shape with the specified half extent.
Box2dShape(float, float) - Constructor for class com.jme3.bullet.collision.shapes.Box2dShape
Instantiate a rectangle shape with the specified half extents.
Box2dShape(Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.Box2dShape
Instantiate a rectangle shape with the specified half extents.
BoxCollisionShape - Class in com.jme3.bullet.collision.shapes
An axis-aligned, rectangular-solid collision shape based on Bullet's btBoxShape.
BoxCollisionShape(float) - Constructor for class com.jme3.bullet.collision.shapes.BoxCollisionShape
Instantiate a cube shape with the specified half extent.
BoxCollisionShape(float, float, float) - Constructor for class com.jme3.bullet.collision.shapes.BoxCollisionShape
Instantiate a box with the specified half extents.
BoxCollisionShape(Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.BoxCollisionShape
Instantiate a box with the specified half extents.
BoxCollisionShape(FloatBuffer, int, int) - Constructor for class com.jme3.bullet.collision.shapes.BoxCollisionShape
Instantiate a box shape that encloses the sample locations in the specified FloatBuffer range.
boxVolume(Vector3f) - Static method in class jme3utilities.math.MyVolume
Compute the volume of a box with the specified half extents.
bRadius() - Method in class com.jme3.bullet.collision.shapes.ConicalFrustum
Return the radius of the "B" base.
brake(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Apply the specified brake impulse to all wheels.
brake(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Apply the specified brake impulse to the indexed wheel.
brake(VehicleWheel, float) - Method in class com.jme3.bullet.objects.infos.VehicleController
Apply the specified brake impulse to the specified wheel.
BufferAllocator - Interface in com.jme3.util
Interface to create/destroy direct buffers.
BufferUtils - Class in com.jme3.util
BufferUtils is a helper class for generating nio buffers from jME data classes such as Vectors.

C

CacheDirection - Static variable in class com.jme3.bullet.SolverMode
enable friction-direction caching
CacheFriendly - Static variable in class com.jme3.bullet.SolverMode
cache friendly
calculatedBasisA(Matrix3f) - Method in class com.jme3.bullet.joints.New6Dof
Calculate the pivot orientation of the A end.
calculatedBasisB(Matrix3f) - Method in class com.jme3.bullet.joints.New6Dof
Calculate the pivot orientation of the B end.
calculatedOriginA(Vector3f) - Method in class com.jme3.bullet.joints.New6Dof
Calculate the pivot location of the A end (native field: m_calculatedTransformA.m_origin).
calculatedOriginB(Vector3f) - Method in class com.jme3.bullet.joints.New6Dof
Calculate the pivot location of the B end (native field: m_calculatedTransformB.m_origin).
calculateNormal() - Method in class com.jme3.math.Triangle
Recalculates the stored normal based on the current vertex locations.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Test whether the specified scale factors can be applied to the shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Test whether the specified scale factors can be applied to the shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Test whether the specified scale factors can be applied to this shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.ConeCollisionShape
Test whether the specified scale factors can be applied to this shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.ConicalFrustum
Test whether the specified scale factors can be applied to the shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.Convex2dShape
Test whether the specified scale factors can be applied to this shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Test whether the specified scale factors can be applied to this shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.MinkowskiSum
Test whether the specified scale factors can be applied to this shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Test whether the specified scale factors can be applied to the shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.SphereCollisionShape
Test whether the specified scale factors can be applied to the shape.
canScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.SphericalSegment
Test whether the specified scale factors can be applied to the shape.
canSet(float) - Method in enum class com.jme3.bullet.joints.motors.MotorParam
Test whether this parameter can be set to the specified value.
canSet(float) - Method in enum class com.jme3.bullet.objects.infos.Cluster
Test whether this parameter can be set to the specified value.
canSet(float) - Method in enum class com.jme3.bullet.objects.infos.Sbcp
Test whether this parameter can be set to the specified value.
canSleep() - Method in class com.jme3.bullet.MultiBody
Test whether this MultiBody can sleep.
canSplit() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Test whether the shape can be split by an arbitrary plane.
canSplit() - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Test whether this shape can be split by an arbitrary plane.
canSplit() - Method in class com.jme3.bullet.collision.shapes.EmptyShape
Test whether the shape can be split by an arbitrary plane.
canSplit() - Method in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Test whether the shape can be split by an arbitrary plane.
canSplit() - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Test whether the shape can be split by an arbitrary plane.
canSplit() - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Test whether this shape can be split by an arbitrary plane.
canWakeup() - Method in class com.jme3.bullet.MultiBody
Test whether this MultiBody can wake up.
CapsuleCollisionShape - Class in com.jme3.bullet.collision.shapes
A capsule collision shape based on Bullet's btCapsuleShapeX, btCapsuleShape, or btCapsuleShapeZ.
CapsuleCollisionShape(float, float) - Constructor for class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Instantiate a Y-axis capsule shape with the specified radius and height.
CapsuleCollisionShape(float, float, int) - Constructor for class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Instantiate a capsule shape around the specified main (height) axis.
capsuleVolume(float, float) - Static method in class jme3utilities.math.MyVolume
Compute the volume of a capsule with the specified radius and height.
cardinalizeLocal(Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Find the cardinal rotation most similar to the specified Quaternion.
castRay(int) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Compute depth for the indexed wheel by raycasting.
castRay(VehicleWheel) - Method in class com.jme3.bullet.objects.infos.VehicleController
Determine the depth for the specified wheel by raycasting.
CHARACTER_OBJECT - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag for a character object, such as a PhysicsCharacter
CharacterController - Class in com.jme3.bullet.objects.infos
The "action" (controller) portion of a PhysicsCharacter, based on Bullet's btKinematicCharacterController.
CharacterController(PhysicsCharacter) - Constructor for class com.jme3.bullet.objects.infos.CharacterController
Instantiate a controller for the specified collision object.
checkParameters() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Compare Bullet parameters against their local copies.
checkRotationOrder() - Method in class com.jme3.bullet.joints.New6Dof
Compare Bullet's rotation order to the JVM copy.
ChildCollisionShape - Class in com.jme3.bullet.collision.shapes.infos
An element in a CompoundCollisionShape, consisting of a (non-compound) base shape, offset and rotated with respect to its parent.
ChildCollisionShape(Vector3f, CollisionShape) - Constructor for class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Instantiate a child without any rotation.
ChildCollisionShape(Vector3f, Matrix3f, CollisionShape) - Constructor for class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Instantiate a child for use in a compound shape.
ChildShapes - Enum constant in enum class jme3utilities.minie.DumpFlags
children in compound collision shapes
circle(double) - Static method in class jme3utilities.math.MyMath
Return the circle function sqrt(1 - x^2) for a double-precision value.
circle(float) - Static method in class jme3utilities.math.MyMath
Return the circle function sqrt(1 - x^2) for a single-precision value.
CL_RS - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the Cluster-versus-Convex handler for rigid-versus-soft collisions
CL_SELF - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable self collisions for clusters
CL_SS - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the Cluster-versus-Cluster handler for soft-versus-soft collisions
clamp(double, double, double) - Static method in class jme3utilities.math.MyMath
Clamp a double-precision value between 2 limits.
clamp(float, float, float) - Static method in class com.jme3.math.FastMath
Take a float input and clamp it between min and max.
clamp(int, int, int) - Static method in class jme3utilities.math.MyMath
Clamp an integer value between 2 limits.
clear() - Method in interface jme3utilities.math.VectorSet
Reset this set to its initial (empty) state without altering its capacity.
clear() - Method in class jme3utilities.math.VectorSetUsingBuffer
Reset this set to its initial (empty, flipped, rewound) state without altering its capacity.
clearConstraintForces() - Method in class com.jme3.bullet.MultiBody
Clear all constraint forces.
clearForces() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Clear all forces and torques acting on the body, including gravity.
clearForcesAndTorques() - Method in class com.jme3.bullet.MultiBody
Clear all external forces and torques.
clearIgnoreList() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Clear this object's ignore list.
clearStats() - Static method in class jme3utilities.math.VectorSetUsingBuffer
Reset the hashing statistics.
clearVelocities() - Method in class com.jme3.bullet.MultiBody
Zero out all velocities.
clone() - Method in class com.jme3.math.Matrix3f
Creates a copy.
clone() - Method in class com.jme3.math.Matrix4f
Creates a copy.
clone() - Method in class com.jme3.math.Plane
Create a copy of this plane.
clone() - Method in class com.jme3.math.Quaternion
Creates a copy.
clone() - Method in class com.jme3.math.Transform
Creates a copy.
clone() - Method in class com.jme3.math.Vector3f
Creates a copy.
clone() - Method in class com.simsilica.mathd.Matrix3d
Creates a copy of the current instance.
clone() - Method in class com.simsilica.mathd.Quatd
Creates a copy.
clone() - Method in class com.simsilica.mathd.Vec3d
Creates a copy.
clone() - Method in class jme3utilities.debug.Describer
Create a copy of this Describer.
clone() - Method in class jme3utilities.debug.Dumper
Create a deep copy of this Dumper.
clone() - Method in class jme3utilities.minie.PhysicsDescriber
Create a copy of this PhysicsDescriber.
clone() - Method in class jme3utilities.minie.PhysicsDumper
Create a deep copy of this dumper.
clone() - Method in class vhacd.VHACDParameters
Create a copy of these parameters.
clone() - Method in class vhacd4.Vhacd4Parameters
Create a copy of these parameters.
clonePositions() - Method in class vhacd.VHACDHull
Copy the vertex positions to a new array.
clonePositions() - Method in class vhacd4.Vhacd4Hull
Copy the vertex positions to a new array.
Cluster - Enum Class in com.jme3.bullet.objects.infos
Enumerate the float-valued parameters in a soft-body cluster.
clusterCenter(int, Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the center location of the indexed cluster.
clusterIndexA() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Read the index of the cluster for the A end.
clusterIndexB() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Read the index of the cluster for the B end.
clusterIterations() - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Return the number of cluster-solver iterations (native field: citerations).
ClusterKineticHardness - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
cluster-versus-kinetic hardness coefficient (≥0, ≤1, default=1, native field: kSKHR_CL)
ClusterKineticSplit - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
cluster-versus-kinetic impulse-split coefficient (≥0, ≤1, default=0.5, native field: kSK_SPLT_CL)
ClusterRigidHardness - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
cluster-versus-rigidBody hardness coefficient (≥0, ≤1, default=0.1, native field: kSRHR_CL)
ClusterRigidSplit - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
cluster-versus-rigidBody impulse-split coefficient (≥0, ≤1, default=0.5, native field: kSR_SPLT_CL)
ClustersInSofts - Enum constant in enum class jme3utilities.minie.DumpFlags
clusters in soft bodies
ClusterSoftHardness - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
cluster-versus-softBody hardness coefficient (≥0, ≤1, default=0.5, native field: kSSHR_CL)
ClusterSoftSplit - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
cluster-versus-softBody impulse-split coefficient (≥0, ≤1, default=0.5, native field: kSS_SPLT_CL).
collider - Static variable in class com.jme3.bullet.collision.PcoType
value for a MultiBodyCollider (native name: CO_FEATHERSTONE_LINK)
collideWithGroups() - Method in class com.jme3.bullet.MultiBody
Return the set of collision groups with which this multibody can collide.
collision(PhysicsCollisionEvent) - Method in interface com.jme3.bullet.collision.PhysicsCollisionListener
Callback to report collisions in a CollisionSpace.
COLLISION_GROUP_01 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #1
COLLISION_GROUP_02 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #2
COLLISION_GROUP_03 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #3
COLLISION_GROUP_04 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #4
COLLISION_GROUP_05 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #5
COLLISION_GROUP_06 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #6
COLLISION_GROUP_07 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #7
COLLISION_GROUP_08 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #8
COLLISION_GROUP_09 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #9
COLLISION_GROUP_10 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #10
COLLISION_GROUP_11 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #11
COLLISION_GROUP_12 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #12
COLLISION_GROUP_13 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #13
COLLISION_GROUP_14 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #14
COLLISION_GROUP_15 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #15
COLLISION_GROUP_16 - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collisionGroup/collideWithGroups bitmask that represents group #16
COLLISION_GROUP_NONE - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
collideWithGroups bitmask that represents "no groups"
CollisionConfiguration - Class in com.jme3.bullet
Tuning parameters for a CollisionSpace, based on Bullet's btDefaultCollisionConstructionInfo.
CollisionConfiguration() - Constructor for class com.jme3.bullet.CollisionConfiguration
Instantiate an instance with the default parameter values.
CollisionConfiguration(int, int) - Constructor for class com.jme3.bullet.CollisionConfiguration
Instantiate an instance with the specified parameter values.
CollisionFlag - Class in com.jme3.bullet.collision
Named collision flags for a PhysicsCollisionObject.
collisionFlags() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision flags.
collisionFlags() - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Return the collisions flags (native field: collisions).
collisionGroup() - Method in class com.jme3.bullet.MultiBody
Return the collision group of this multibody.
CollisionShape - Class in com.jme3.bullet.collision.shapes
The abstract base class for collision shapes based on Bullet's btCollisionShape.
CollisionShape() - Constructor for class com.jme3.bullet.collision.shapes.CollisionShape
Instantiate a collision shape with no tracker and no assigned native object.
CollisionSpace - Class in com.jme3.bullet
A Bullet-JME collision space with its own btCollisionWorld.
CollisionSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType) - Constructor for class com.jme3.bullet.CollisionSpace
Instantiate a CollisionSpace.
CollisionSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, int) - Constructor for class com.jme3.bullet.CollisionSpace
Used internally.
CollisionSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, int, CollisionConfiguration) - Constructor for class com.jme3.bullet.CollisionSpace
Used internally.
com.jme3.bounding - package com.jme3.bounding
bounding volumes for collision detection and scene-graph culling
com.jme3.bullet - package com.jme3.bullet
PhysicsSpace and some associated classes and interfaces.
com.jme3.bullet.collision - package com.jme3.bullet.collision
Classes and interfaces associated with physics-oriented collision detection and ray/sweep tests.
com.jme3.bullet.collision.shapes - package com.jme3.bullet.collision.shapes
Collision shapes, used to describe the shapes of Bullet collision objects other than soft bodies.
com.jme3.bullet.collision.shapes.infos - package com.jme3.bullet.collision.shapes.infos
Auxiliary classes that relate to collision shapes.
com.jme3.bullet.joints - package com.jme3.bullet.joints
Physics joints based on Bullet's btTypedConstraint.
com.jme3.bullet.joints.motors - package com.jme3.bullet.joints.motors
Classes that provide access to the motors in a SixDofJoint or New6Dof.
com.jme3.bullet.objects - package com.jme3.bullet.objects
Collision-object classes.
com.jme3.bullet.objects.infos - package com.jme3.bullet.objects.infos
Auxiliary classes that relate to collision objects.
com.jme3.bullet.util - package com.jme3.bullet.util
Utility classes for Bullet physics and related classes.
com.jme3.math - package com.jme3.math
Single-precision arithmetic.
com.jme3.system - package com.jme3.system
interface with the underlying operating system
com.jme3.util - package com.jme3.util
utility classes and miscellaneous useful algorithms
com.simsilica.mathd - package com.simsilica.mathd
Double-precision arithmetic on vectors and quaternions.
combine(Transform, Transform, Transform) - Static method in class jme3utilities.math.MyMath
Combine the specified transforms.
combineWithParent(TransformDp) - Method in class com.jme3.math.TransformDp
Combines with the argument and returns the (modified) current instance.
compareTo(NativePhysicsObject) - Method in class com.jme3.bullet.NativePhysicsObject
Compare (by ID) with another native object.
compareTo(IntPair) - Method in class jme3utilities.math.IntPair
Compare to another IntPair, with the smaller elements having priority.
CompoundCollisionShape - Class in com.jme3.bullet.collision.shapes
A collision shape formed by combining child shapes, based on Bullet's btCompoundShape.
CompoundCollisionShape() - Constructor for class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Instantiate an empty compound shape (with an initial capacity of 6, dynamic AABB, and no children).
CompoundCollisionShape(int) - Constructor for class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Instantiate an empty compound shape with the specified initial capacity (and dynamic AABB and no children).
CompoundMesh - Class in com.jme3.bullet.collision.shapes.infos
A scalable mesh that combines multiple indexed meshes.
CompoundMesh() - Constructor for class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Instantiate an empty mesh.
CompoundMesh(CompoundMesh) - Constructor for class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Copy an existing mesh.
CompoundMesh(CompoundMesh, Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Instantiate a mesh by applying an offset to an existing mesh.
compute(float[], int[], VHACDParameters) - Static method in class vhacd.VHACD
Generate convex hulls to approximate the specified mesh.
compute(float[], int[], Vhacd4Parameters) - Static method in class vhacd4.Vhacd4
Generate convex hulls to approximate the specified mesh.
ConeCollisionShape - Class in com.jme3.bullet.collision.shapes
A conical collision shape based on Bullet's btConeShapeX, btConeShape, or btConeShapeZ.
ConeCollisionShape(float, float) - Constructor for class com.jme3.bullet.collision.shapes.ConeCollisionShape
Instantiate a cone shape, oriented along the local Y axis.
ConeCollisionShape(float, float, int) - Constructor for class com.jme3.bullet.collision.shapes.ConeCollisionShape
Instantiate a cone shape around the specified main (height) axis.
ConeJoint - Class in com.jme3.bullet.joints
A 3 degree-of-freedom joint based on Bullet's btConeTwistConstraint.
ConeJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.joints.ConeJoint
Instantiate a double-ended ConeJoint.
ConeJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, Matrix3f, Matrix3f) - Constructor for class com.jme3.bullet.joints.ConeJoint
Instantiate a double-ended ConeJoint.
ConeJoint(PhysicsRigidBody, Vector3f, Matrix3f) - Constructor for class com.jme3.bullet.joints.ConeJoint
Instantiate a single-ended ConeJoint with its pivot at the physics-space origin.
coneVolume(float, float) - Static method in class jme3utilities.math.MyVolume
Compute the volume of a cone with the specified radius and height.
ConfigFlag - Class in com.jme3.bullet.objects.infos
Named collision flags for use with a SoftBodyConfig.
configureFixedLink(float, Vector3f, MultiBodyLink, Quaternion, Vector3f, Vector3f) - Method in class com.jme3.bullet.MultiBody
Configure a new link that is fixed to its parent.
configurePlanarLink(float, Vector3f, MultiBodyLink, Quaternion, Vector3f, Vector3f, boolean) - Method in class com.jme3.bullet.MultiBody
Configure a link that is joined to its parent with a planar joint.
configurePrismaticLink(float, Vector3f, MultiBodyLink, Quaternion, Vector3f, Vector3f, Vector3f, boolean) - Method in class com.jme3.bullet.MultiBody
Configure a link that is joined to its parent with a prismatic joint.
configureRevoluteLink(float, Vector3f, MultiBodyLink, Quaternion, Vector3f, Vector3f, Vector3f, boolean) - Method in class com.jme3.bullet.MultiBody
Configure a link that is joined to its parent with a revolute joint.
configureSphericalLink(float, Vector3f, MultiBodyLink, Quaternion, Vector3f, Vector3f, boolean) - Method in class com.jme3.bullet.MultiBody
Configure a link that is joined to its parent with a spherical joint.
ConicalFrustum - Class in com.jme3.bullet.collision.shapes
A collision shape for a conical frustum with uniform density, based on btConvexInternalShape.
ConicalFrustum(float, float, float) - Constructor for class com.jme3.bullet.collision.shapes.ConicalFrustum
Instantiate a conical frustum with the specified dimensions.
conjugate(Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Return the conjugate of a Quaternion.
connectivityMatrix(CollisionSpace) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Generate a connectivity matrix for the children.
constant - Variable in class com.jme3.math.Plane
Constant of the plane.
Constraint - Class in com.jme3.bullet.joints
The abstract base class for rigid-body physics joints based on Bullet's btTypedConstraint.
Constraint(PhysicsBody, PhysicsBody, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.joints.Constraint
Instantiate an enabled, double-ended Constraint.
Constraint(PhysicsRigidBody, JointEnd, Vector3f) - Constructor for class com.jme3.bullet.joints.Constraint
Instantiate an enabled, single-ended Constraint using the specified body at the specified end.
Constraint(PhysicsRigidBody, JointEnd, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.joints.Constraint
Instantiate an enabled, single-ended Constraint using the specified body at the specified end.
constraintForce(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the net constraint force on this link.
constraintTorque(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the net constraint torque on this link.
CONTACT_STIFFNESS_DAMPING - Static variable in class com.jme3.bullet.collision.ContactPointFlag
contact has stiffness damping
contactErp() - Method in class com.jme3.bullet.SolverInfo
Return the error-reduction parameter for contact constraints (native field: m_erp2).
ContactListener - Interface in com.jme3.bullet.collision
Interface to receive immediate notifications when 2 collision objects come into contact.
ContactPointFlag - Class in com.jme3.bullet.collision
Named flags for a PhysicsCollisionEvent.
contactTest(PhysicsCollisionObject, PhysicsCollisionListener) - Method in class com.jme3.bullet.CollisionSpace
Perform a contact test.
contains(float, float, float) - Method in interface jme3utilities.math.VectorSet
Test whether this set contains the specified value.
contains(float, float, float) - Method in class jme3utilities.math.VectorSetUsingBuffer
Test whether this set contains the specified value.
contains(PhysicsCollisionObject) - Method in class com.jme3.bullet.CollisionSpace
Test whether the specified collision object is added to the space.
contains(PhysicsCollisionObject) - Method in class com.jme3.bullet.DeformableSpace
Test whether the specified collision object is added to this space.
contains(PhysicsCollisionObject) - Method in class com.jme3.bullet.MultiBodySpace
Test whether the specified collision object is added to this space.
contains(PhysicsCollisionObject) - Method in class com.jme3.bullet.PhysicsSoftSpace
Test whether the specified collision object is added to this space.
contains(PhysicsCollisionObject) - Method in class com.jme3.bullet.PhysicsSpace
Test whether the specified collision object is added to the space.
contains(PhysicsJoint) - Method in class com.jme3.bullet.PhysicsSpace
Test whether the specified PhysicsJoint is added to the space.
contains(MultiBodyCollider) - Method in class com.jme3.bullet.MultiBody
Test whether the specified collider is part of this MultiBody.
contains(Vector3f) - Method in interface jme3utilities.math.VectorSet
Test whether this set contains the value of the specified Vector3f.
contains(Vector3f) - Method in class jme3utilities.math.VectorSetUsingBuffer
Test whether this set contains the value of the specified Vector3f.
Convex2dShape - Class in com.jme3.bullet.collision.shapes
A convex collision shape optimized for 2-D, based on Bullet's btConvex2dShape.
Convex2dShape(ConvexShape) - Constructor for class com.jme3.bullet.collision.shapes.Convex2dShape
Instantiate a shape based on the specified convex shape.
Convex2dShape(FloatBuffer) - Constructor for class com.jme3.bullet.collision.shapes.Convex2dShape
Instantiate a 2-D hull shape based on a flipped buffer containing coordinates.
ConvexShape - Class in com.jme3.bullet.collision.shapes
The abstract base class for convex collision shapes based on Bullet's btConvexShape.
ConvexShape() - Constructor for class com.jme3.bullet.collision.shapes.ConvexShape
Instantiate a collision shape with no tracker and no assigned native object.
copyAabb(BoundingBox) - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Copy the bounds of the hierarchy.
copyAll(CharacterController) - Method in class com.jme3.bullet.objects.infos.CharacterController
Copy all parameter values from the specified controller.
copyAll(SoftBodyConfig) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Copy all parameter values from the specified config.
copyAll(SoftBodyWorldInfo) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Copy all parameter values from the specified info.
copyAll(SolverInfo) - Method in class com.jme3.bullet.SolverInfo
Copy all parameter values from the specified info.
copyAxis(Vector3f) - Method in class com.jme3.bullet.joints.SoftAngularJoint
Copy the joint axis.
copyBuffer() - Method in class jme3utilities.lbj.IndexBuffer
Copy all the indices to a new direct buffer.
copyCenter(int, Vector3f) - Method in class com.jme3.bullet.collision.shapes.MultiSphere
Copy the location of the center of the indexed sphere.
copyClusterCenters(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the center-of-mass locations of all clusters in this body.
copyClusterMasses(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the masses of all clusters in this body.
copyClusterVelocities(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the (linear) velocities of all clusters in this body.
copyFaces(IntBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the node indices of all faces in this body.
copyGravity(Vector3f) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Copy the gravitational acceleration.
copyHullVertices() - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Copy the unscaled vertex locations of the optimized convex hull.
copyIndices() - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Copy the triangle indices.
copyLinks(IntBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the node indices of all links in this body.
copyLocation(Vector3f) - Method in class com.jme3.bullet.joints.SoftLinearJoint
Copy the joint location.
copyLocations(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the locations of all nodes in this body.
copyMasses(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the masses of all nodes in this body.
copyNormals(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the normal vectors of all nodes in this body.
copyOffset(Vector3f) - Method in class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Copy the translation in the parent's coordinate system.
copyPcoProperties(PhysicsCollisionObject) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy common properties from another collision object.
copyPivot(Vector3f) - Method in class com.jme3.bullet.joints.Anchor
Copy the location of the connection point in the rigid body at the B end.
copyQuantization(Vector3f) - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Copy the quantization vector of the hierarchy.
copyRotation(Quaternion) - Method in class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Copy the rotation in the parent's coordinate system.
copyRotationMatrix(Matrix3f) - Method in class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Copy the rotation in the parent's coordinate system.
copyTetras(IntBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the node indices of all tetrahedra in this body.
copyTransform(Transform) - Method in class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Copy the Transform relative to the parent's coordinate system.
copyTriangle(int, Triangle) - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Copy the vertex positions of the specified triangle.
copyTriangles() - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Copy the unindexed triangle vertices to a new buffer.
copyVelocities(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the (linear) velocities of all nodes in this body.
copyVertex(int, Vector3f) - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Copy the indexed vertex.
copyVertexPositions() - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Copy the vertex positions to a new buffer.
copyVertices() - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Copy the unscaled vertex locations.
copyWaterNormal(Vector3f) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Copy the normal direction of the water surface.
correctAxes(Transform) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Apply the inverse of the specified Transform to each child shape.
cos(float) - Static method in class com.jme3.math.FastMath
Returns cosine of an angle.
countChildren() - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Count the child shapes.
countClampedCcdMotions() - Static method in class com.jme3.bullet.util.NativeLibrary
Count the cumulative number of clamped CCD motions (native variable: gNumClampedCcdMotions).
countClusters() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Count the clusters in this body.
countCollisionObjects() - Method in class com.jme3.bullet.CollisionSpace
Count the collision objects in the space.
countColumns() - Method in class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
Count how many columns are in the heightfield.
countConfiguredLinks() - Method in class com.jme3.bullet.MultiBody
Count the configured links in this MultiBody.
countDistinct() - Method in class jme3utilities.math.DistinctVectorValues
Count the number of distinct vectors in the original buffer range.
countDofs() - Method in class com.jme3.bullet.MultiBody
Count the degrees of freedom.
countDofs() - Method in class com.jme3.bullet.MultiBodyLink
Count the degrees of freedom in the joint.
countEnds() - Method in class com.jme3.bullet.joints.PhysicsJoint
Count how many ends this joint has.
countFaces() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Count the faces in this body.
countGroups(CollisionSpace, int[]) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Enumerate disconnected groups of connected children.
countHullVertices() - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Count the number of vertices in the optimized convex hull.
countIgnored() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Count the collision objects in this object's ignore list.
countJoints() - Method in class com.jme3.bullet.DeformableSpace
Count the joints in this space, including anchors and soft-body joints.
countJoints() - Method in class com.jme3.bullet.objects.PhysicsBody
Count how many joints connect to this body.
countJoints() - Method in class com.jme3.bullet.PhysicsSoftSpace
Count the joints in this space, including anchors and soft-body joints.
countJoints() - Method in class com.jme3.bullet.PhysicsSpace
Count the joints in the space.
countLeafNodes() - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Count the leaf nodes in the hierarchy.
countLinks() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Count the links in this body.
countManifolds() - Method in class com.jme3.bullet.PhysicsSpace
Count the collision manifolds in the space.
countMeshTriangles() - Method in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Count how many triangles are in the mesh.
countMeshTriangles() - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Count how many triangles are in the mesh.
countMeshVertices() - Method in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Count how many vertices are in the mesh.
countMeshVertices() - Method in class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
Count how many heights are in the heightfield.
countMeshVertices() - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Count the vertices used to generate the hull.
countMeshVertices() - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Count how many vertices are in the mesh.
countMeshVertices() - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Count the points used to generate the simplex.
countMultiBodies() - Method in class com.jme3.bullet.MultiBodySpace
Count the multibodies in this space.
countNodes() - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Count all nodes in the hierarchy.
countNodes() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Count the nodes in this body.
countNodesInCluster(int) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Count the nodes in the indexed cluster.
countPinnedNodes() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Count the pinned nodes in this body.
countPoints(long) - Static method in class com.jme3.bullet.collision.PersistentManifolds
Return the number of points in the specified manifold (native field: m_cachedPoints).
countPositionVariables() - Method in class com.jme3.bullet.MultiBody
Count the position variables in this MultiBody.
countPositionVariables() - Method in class com.jme3.bullet.MultiBodyLink
Count the position variables in the joint.
countRigidBodies() - Method in class com.jme3.bullet.PhysicsSpace
Count the rigid bodies in the space, including vehicles.
countRows() - Method in class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
Count how many rows are in the heightfield.
countSoftBodies() - Method in class com.jme3.bullet.DeformableSpace
Count the soft bodies in this space.
countSoftBodies() - Method in class com.jme3.bullet.PhysicsSoftSpace
Count the soft bodies in this space.
countSolvers() - Method in class com.jme3.bullet.CollisionSpace
Count the worker threads.
countSpheres() - Method in class com.jme3.bullet.collision.shapes.MultiSphere
Count the spheres in the shape.
countSubmeshes() - Method in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Count how many submeshes are in the mesh.
countSubmeshes() - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Count how many submeshes are in this mesh.
countSubmeshes() - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Count how many submeshes are in the mesh.
countSubtreeHeaders() - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Count the subtree headers in the hierarchy (native field: m_SubtreeHeaders).
countTetras() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Count the tetrahedra in this body.
countThreads() - Static method in class com.jme3.bullet.util.NativeLibrary
Count how many threads are available for task scheduling.
countTickListeners() - Method in class com.jme3.bullet.PhysicsSpace
Count how many tick listeners are registered with the space.
countTrackers() - Static method in class com.jme3.bullet.NativePhysicsObject
Count how many native objects are being tracked.
countTriangles() - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Count how many triangles are in this mesh.
countTriangles() - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Count how many triangles are in this mesh.
countVertices() - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Count how many vertices are in this mesh.
countVertices() - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Count how many vertices are in this mesh.
countWheels() - Method in class com.jme3.bullet.objects.infos.VehicleController
Determine the number of wheels in this controller.
covariance(Matrix3f) - Method in interface jme3utilities.math.VectorSet
Determine the sample covariance of the values in this set.
covariance(Matrix3f) - Method in class jme3utilities.math.VectorSetUsingBuffer
Determine the sample covariance of the values in this set.
covariance(FloatBuffer, int, int, Matrix3f) - Static method in class jme3utilities.math.MyBuffer
Return the sample covariance of the 3-D vectors in the specified FloatBuffer range.
crash() - Static method in class com.jme3.bullet.util.NativeLibrary
Crash the JVM with an EXCEPTION_ACCESS_VIOLATION or SIGILL.
create() - Method in class com.jme3.bullet.CollisionSpace
Must be invoked on the designated physics thread.
create() - Method in class com.jme3.bullet.DeformableSpace
Must be invoked on the designated physics thread.
create() - Method in class com.jme3.bullet.MultiBodySpace
Must be invoked on the designated physics thread.
create() - Method in class com.jme3.bullet.PhysicsSoftSpace
Must be invoked on the designated physics thread.
create() - Method in class com.jme3.bullet.PhysicsSpace
Must be invoked on the designated physics thread.
createByteBuffer(int) - Static method in class com.jme3.util.BufferUtils
Create a new ByteBuffer of the specified size.
createFloatBuffer(float...) - Static method in class com.jme3.util.BufferUtils
Generate a new FloatBuffer using the given array of float primitives.
createFloatBuffer(int) - Static method in class com.jme3.util.BufferUtils
Create a new FloatBuffer of the specified size.
createFloatBuffer(Vector3f...) - Static method in class com.jme3.util.BufferUtils
Generate a new FloatBuffer using the given array of Vector3f objects.
createIndexBuffer(int, int) - Static method in class jme3utilities.lbj.IndexBuffer
Create a mutable IndexBuffer with a new direct data buffer.
createIntBuffer(int) - Static method in class com.jme3.util.BufferUtils
Create a new IntBuffer of the specified size.
createIntBuffer(int...) - Static method in class com.jme3.util.BufferUtils
Generate a new IntBuffer using the given array of ints.
createJoint(long, long, Vector3f, Matrix3f, Vector3f, Matrix3f, boolean) - Method in class com.jme3.bullet.joints.SixDofJoint
Create a double-ended btGeneric6DofConstraint.
createJoint(long, long, Vector3f, Matrix3f, Vector3f, Matrix3f, boolean) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Create a double-ended btGeneric6DofSpringConstraint.
createJoint1(long, Vector3f, Matrix3f, boolean) - Method in class com.jme3.bullet.joints.SixDofJoint
Create a single-ended btGeneric6DofConstraint.
createJoint1(long, Vector3f, Matrix3f, boolean) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Create a single-ended btGeneric6DofSpringConstraint.
createShortBuffer(int) - Static method in class com.jme3.util.BufferUtils
Create a new ShortBuffer of the specified size.
createTestPoint() - Static method in class com.jme3.bullet.collision.ManifoldPoints
Create a manifold point (for testing) that will never be freed.
createVehicle(PhysicsSpace) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Used internally, creates the controller when the vehicle is added to a PhysicsSpace.
cross(float, float, float, Vector3f) - Method in class com.jme3.math.Vector3f
Calculates a cross product with specified components and returns the product in the specified vector.
cross(Vector3f) - Method in class com.jme3.math.Vector3f
Calculates a cross product with the argument and returns the product as a new instance.
cross(Vector3f, Vector3f) - Method in class com.jme3.math.Vector3f
Calculates a cross product with a specified vector and returns the product in a 3rd vector.
cross(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Calculates a cross product with the argument and returns the product as a new instance.
crossLocal(float, float, float) - Method in class com.jme3.math.Vector3f
Right multiplies by the specified components (cross product) and returns the (modified) current instance.
cube(float) - Static method in class jme3utilities.math.MyMath
Cube the specified single-precision value.
CUSTOM_MATERIAL_CALLBACK - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag to enable a custom material callback for per-triangle friction/restitution (not supported by Libbulletjme)
CustomConvexShape - Class in com.jme3.bullet.collision.shapes
An abstract base class for collision shapes defined in terms of their supporting vertices, based on Bullet's btConvexInternalShape.
CustomConvexShape(float, float, float) - Constructor for class com.jme3.bullet.collision.shapes.CustomConvexShape
Instantiate a custom collision shape with the specified extents.
CustomConvexShape(Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.CustomConvexShape
Instantiate a custom collision shape with the specified extents.
cutLink(int, int, float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Cut a pre-existing link in this body.
CylinderCollisionShape - Class in com.jme3.bullet.collision.shapes
A cylindrical collision shape based on Bullet's btCylinderShapeX, btCylinderShape, or btCylinderShapeZ.
CylinderCollisionShape(float, float, int) - Constructor for class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Instantiate a cylinder shape around the specified main (height) axis.
CylinderCollisionShape(Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Instantiate a Z-axis cylinder shape with the specified half extents.
CylinderCollisionShape(Vector3f, int) - Constructor for class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Instantiate a cylinder shape around the specified main (height) axis.
CylinderCollisionShape(FloatBuffer, int, int, int) - Constructor for class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Instantiate a cylinder shape that encloses the sample locations in the specified FloatBuffer range.
cylinderRadius(FloatBuffer, int, int, int) - Static method in class jme3utilities.math.MyBuffer
Return the radius of a bounding cylinder for the specified FloatBuffer range.
cylinderVolume(Vector3f) - Static method in class jme3utilities.math.MyVolume
Compute the volume of a cylinder with specified half extents.

D

Damping - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
spring's viscous damping ratio (m_springDamping, default=0)
Damping - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
damping coefficient (≥0, ≤1, default=0, native field: kDP)
Dantzig - Enum constant in enum class com.jme3.bullet.SolverType
btDantzigSolver: Mixed Linear Complementarity Problem (MLCP) direct solver using the Dantzig Algorithm
DBVT - Enum constant in enum class com.jme3.bullet.PhysicsSpace.BroadphaseType
btDbvtBroadphase: a fast, dynamic bounding-volume hierarchy based on AABB tree to allow quicker addition/removal of physics objects
DebugShapeFactory - Class in com.jme3.bullet.util
A utility class to generate debug meshes for Bullet collision shapes.
debugVertices(CollisionShape, int) - Static method in class com.jme3.bullet.util.DebugShapeFactory
Determine vertex locations for the specified collision shape.
defaultForRotationMotor() - Method in enum class com.jme3.bullet.joints.motors.MotorParam
Determine the default value for this parameter in a RotationMotor.
defaultForTranslationMotor() - Method in enum class com.jme3.bullet.joints.motors.MotorParam
Determine the default value for this parameter in a TranslationMotor.
DeformableSpace - Class in com.jme3.bullet
A MultiBodySpace that supports deformables, with its own btDeformableMultiBodyDynamicsWorld.
DeformableSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, SolverType) - Constructor for class com.jme3.bullet.DeformableSpace
Instantiate a DeformableSpace with the specified contact-and-constraint solver.
defValue() - Method in enum class com.jme3.bullet.objects.infos.Cluster
Determine the default value for this parameter.
defValue() - Method in enum class com.jme3.bullet.objects.infos.Sbcp
Determine the default value for this parameter.
DEG_TO_RAD - Static variable in class com.jme3.math.FastMath
A value to multiply a degree value by, to convert it to radians.
describe(float) - Static method in class jme3utilities.MyString
Generate a textual description of a single-precision floating-point value.
describe(int) - Static method in class com.jme3.bullet.objects.infos.ConfigFlag
Generate a textual description of the specified flags.
describe(int) - Static method in class com.jme3.bullet.RayTestFlag
Generate a textual description of the specified flags.
describe(int) - Static method in class com.jme3.bullet.SolverMode
Generate a textual description of the specified flags.
describe(BoundingBox) - Method in class jme3utilities.debug.Describer
Generate a compact, textual description of the specified BoundingBox.
describe(CollisionShape) - Method in class jme3utilities.minie.PhysicsDescriber
Generate a textual description for a CollisionShape.
describe(CollisionConfiguration) - Method in class jme3utilities.minie.PhysicsDescriber
Generate a textual description for a CollisionConfiguration.
describe(RotationalLimitMotor) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the specified RotationalLimitMotor.
describe(TranslationalLimitMotor, int) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the indexed axis of the specified TranslationalLimitMotor.
describe(PhysicsJoint) - Method in class jme3utilities.minie.PhysicsDescriber
Generate a brief textual description for a PhysicsJoint.
describe(SoftBodyMaterial) - Method in class jme3utilities.minie.PhysicsDescriber
Generate a brief textual description for the specified PhysicsSoftBody.Material
describe(PhysicsRigidBody) - Static method in class jme3utilities.minie.MyPco
Briefly describe a rigid body for PhysicsDumper.
describe(VehicleWheel) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the specified VehicleWheel.
describe(SoftBodyWorldInfo) - Method in class jme3utilities.minie.PhysicsDescriber
Generate a brief textual description for the specified SoftBodyWorldInfo.
describe(Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Generate a textual description of a Quaternion value.
describe(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Generate a textual description of a Vector3f value.
describe1(SoftBodyConfig) - Method in class jme3utilities.minie.PhysicsDescriber
Generate the first line of a textual description for the specified SoftBodyConfig.
describe2(SoftBodyConfig) - Method in class jme3utilities.minie.PhysicsDescriber
Generate the 2nd line of a brief textual description for the specified SoftBodyConfig.
describe2(VehicleWheel) - Method in class jme3utilities.minie.PhysicsDescriber
Generate the 2nd line of a textual description for the specified VehicleWheel.
describeAngular(SixDofJoint) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the angular components of the specified SixDofJoint.
describeDirection(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Generate a textual description of a direction vector.
describeDof(New6Dof, int) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the indexed degree of freedom of the specified New6Dof constraint.
describeFraction(float) - Static method in class jme3utilities.MyString
Generate a textual description of a single-precision floating-point value using at most 3 decimal places.
describeGroups(PhysicsCollisionObject) - Method in class jme3utilities.minie.PhysicsDescriber
Briefly describe the collision group and collide-with groups of the specified collision object.
describeHalfExtents(Vector3f) - Method in class jme3utilities.debug.Describer
Describe the specified half extents.
describeJointInBody(PhysicsJoint, PhysicsBody, boolean) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the specified PhysicsJoint in the context of the specified body.
describeJointInSpace(PhysicsJoint, boolean) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the specified joint in the context of a PhysicsSpace.
describeLinear(SixDofJoint) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the linear components of the specified SixDofJoint.
describeMatrix(Matrix3f) - Static method in class jme3utilities.MyString
Generate a textual description of a Matrix3f value.
Describer - Class in jme3utilities.debug
Generate compact textual descriptions of Libbulletjme objects.
Describer() - Constructor for class jme3utilities.debug.Describer
Instantiate a Describer with the default separator.
describeScale(Vector3f) - Method in class jme3utilities.debug.Describer
Generate a compact, textual description of the specified scale vector.
describeType(CollisionShape) - Static method in class jme3utilities.minie.MyShape
Describe the type of the specified shape.
describeUser(PhysicsCollisionObject) - Method in class jme3utilities.minie.PhysicsDescriber
Describe the user of a collision object.
destroy() - Method in class com.jme3.bullet.CollisionSpace
Remove all collision objects and physics joints.
destroy() - Method in class com.jme3.bullet.DeformableSpace
Remove all collision objects and physics joints.
destroy() - Method in class com.jme3.bullet.joints.PhysicsJoint
Remove this joint from the joint lists of both ends.
destroy() - Method in class com.jme3.bullet.MultiBodySpace
Remove all multibodies, collision objects, and physics joints.
destroy() - Method in class com.jme3.bullet.PhysicsSoftSpace
Remove all collision objects and physics joints.
destroy() - Method in class com.jme3.bullet.PhysicsSpace
Remove all collision objects and physics joints.
destroyDirectBuffer(Buffer) - Method in interface com.jme3.util.BufferAllocator
De-allocate a direct buffer.
destroyDirectBuffer(Buffer) - Method in class com.jme3.util.PrimitiveAllocator
De-allocate a direct buffer.
destroySoftBody() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Destroy the pre-existing btSoftBody (if any) except for its worldInfo.
determinant() - Method in class com.jme3.math.Matrix3f
Returns the determinant.
determinant() - Method in class com.simsilica.mathd.Matrix3d
Returns the determinant.
DIRECTION_Z - Static variable in class com.jme3.math.Quaternion
Another shared instance of the identity quaternion (0, 0, 0, 1).
DISABLE_SPU_COLLISION_PROCESSING - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag to disable parallel/SPU processing (not supported by Libbulletjme)
DISABLE_VISUALIZE_OBJECT - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag to disable debug visualization (not supported by Libbulletjme)
DisableHeightfieldAccelerator - Static variable in class com.jme3.bullet.RayTestFlag
disable the heightfield raycast accelerator (native value: kF_DisableHeightfieldAccelerator)
distance(Vector3f) - Method in class com.jme3.math.Vector3f
Returns the distance between this vector and the argument.
DistinctVectorValues - Class in jme3utilities.math
Analyze a FloatBuffer to identify all of its distinct Vector3f values.
DistinctVectorValues(FloatBuffer, int, int) - Constructor for class jme3utilities.math.DistinctVectorValues
Analyze the specified FloatBuffer range using exact vector comparisons (without distinguishing 0 from -0) and instantiate the results.
divide(float, float, float) - Method in class com.jme3.math.Vector3f
Divides component-wise by the specified components and returns the quotient as a new instance.
divide(Vector3f) - Method in class com.jme3.math.Vector3f
Divides component-wise by the argument and returns the quotient as a new instance.
divideLocal(float) - Method in class com.jme3.math.Vector3f
Divides by the argument and returns the (modified) current instance.
divideLocal(float, float, float) - Method in class com.jme3.math.Vector3f
Divides component-wise by the specified components returns the (modified) current instance.
divideLocal(Vector3f) - Method in class com.jme3.math.Vector3f
Divides component-wise by the argument and returns the (modified) current instance.
divideLocal(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Divides component-wise by the argument and returns the (modified) current instance.
dot(Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Return the dot (scalar) product of 2 quaternions.
dot(Vector3f) - Method in class com.jme3.math.Vector3f
Returns the dot (or inner) product with the argument.
dot(Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVector3f
Determine the dot (scalar) product of 2 vectors.
dot(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Returns the dot (or inner) product with the argument.
Drag - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
drag coefficient (≥0, default=0, native field: kDG)
driftIterations() - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Return the number of drift-solver iterations (native field: diterations).
dump(CollisionShape, String) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified CollisionShape.
dump(PhysicsJoint, String) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified PhysicsJoint in a PhysicsSpace context.
dump(MultiBodyCollider, String) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified MultiBodyCollider.
dump(PhysicsCharacter, String) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified PhysicsCharacter.
dump(PhysicsGhostObject, String) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified PhysicsGhostObject.
dump(PhysicsRigidBody, String) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified PhysicsRigidBody.
dump(PhysicsSoftBody, String) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified PhysicsSoftBody.
dump(PhysicsSpace) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified PhysicsSpace.
dump(PhysicsSpace, String) - Method in class jme3utilities.minie.PhysicsDumper
Dump the specified PhysicsSpace.
Dumper - Class in jme3utilities.debug
Dump portions of a Libbulletjme object for debugging.
Dumper() - Constructor for class jme3utilities.debug.Dumper
Instantiate a dumper that will use System.out for output.
Dumper(PrintStream) - Constructor for class jme3utilities.debug.Dumper
Instantiate a dumper that will use the specified output stream.
DumpFlags - Enum Class in jme3utilities.minie
Enumerate the flags used to configure a PhysicsDumper.
dumpMemoryLeaks() - Static method in class com.jme3.bullet.util.NativeLibrary
Dump all native-memory allocation/free events to standard output.
dumpQuickprof() - Static method in class com.jme3.bullet.util.NativeLibrary
Dump all Quickprof data to standard output.
dumpStats(String) - Static method in class jme3utilities.math.VectorSetUsingBuffer
Print the hashing statistics.
dumpTrackers() - Static method in class com.jme3.bullet.NativePhysicsObject
Dump all native-object trackers to System.out.
DynamicFriction - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
dynamic friction coefficient (≥0, <1, default=0.2, native field: kDF)

E

either - Static variable in class com.jme3.bullet.collision.AfMode
bitmask for either kind of anisotropic friction
EmptyShape - Class in com.jme3.bullet.collision.shapes
An empty collision shape based on Bullet's btEmptyShape.
EmptyShape(boolean) - Constructor for class com.jme3.bullet.collision.shapes.EmptyShape
Instantiate an empty shape.
enableContactFilter - Variable in class com.jme3.bullet.collision.shapes.CollisionShape
copy of the contact-filter enable flag
enableMotor(boolean, float, float) - Method in class com.jme3.bullet.joints.HingeJoint
Enable or disable this joint's motor.
enableSpring(int, boolean) - Method in class com.jme3.bullet.joints.New6Dof
Enable or disable the spring for the indexed degree of freedom.
enableSpring(int, boolean) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Enable or disable the spring for the indexed degree of freedom.
ensureCapacity(int, FloatBuffer) - Static method in class jme3utilities.math.MyBuffer
Reuse the specified FloatBuffer, if it has the required capacity.
equals(Object) - Method in class com.jme3.bullet.NativePhysicsObject
Test for ID equality with another object.
equals(Object) - Method in class com.jme3.math.Matrix3f
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class com.jme3.math.Matrix4f
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class com.jme3.math.Quaternion
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class com.jme3.math.Transform
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class com.jme3.math.TransformDp
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class com.jme3.math.Vector3f
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class com.simsilica.mathd.Matrix3d
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class com.simsilica.mathd.Quatd
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class com.simsilica.mathd.Vec3d
Tests for exact equality with the argument, distinguishing -0 from 0.
equals(Object) - Method in class jme3utilities.math.IntPair
Test for exact equivalence with another Object.
equals(Object) - Method in class vhacd.VHACDParameters
Test for exact equivalence with another Object.
equals(Object) - Method in class vhacd4.Vhacd4Parameters
Test for exact equivalence with another Object.
Equilibrium - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
spring's equilibrium point (m_equilibriumPoint, default=0)
error - Static variable in class com.jme3.bullet.collision.Activation
a disabled collision object: this usually indicates that an error has occurred (native name: DISABLE_SIMULATION)
escape(CharSequence) - Static method in class jme3utilities.MyString
Replace all tab, quote, newline, and backslash characters in the specified text with escape sequences.
escapeIndex(int) - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Return the escape index of the specified node.
exempt - Static variable in class com.jme3.bullet.collision.Activation
a collision object that's exempt from deactivation, such as a vehicle or a kinematic rigid body (native name: DISABLE_DEACTIVATION)
exp(Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Return the exponential of a pure Quaternion.
expectedVersion - Static variable in class com.jme3.bullet.util.NativeLibrary
expected version string of the native library

F

F_OneSided - Enum constant in enum class com.jme3.bullet.objects.infos.Aero
Face normals are taken as they are.
F_TwoSided - Enum constant in enum class com.jme3.bullet.objects.infos.Aero
Face normals are flipped to match velocity.
F_TwoSidedLiftDrag - Enum constant in enum class com.jme3.bullet.objects.infos.Aero
Face normals are flipped to match velocity.
fail() - Static method in class com.jme3.bullet.util.NativeLibrary
Execute btAssert(0).
FastMath - Class in com.jme3.math
FastMath provides 'fast' math approximations and float equivalents of Math functions.
FillMode - Enum Class in com.jme3.bullet
Enumerate algorithms to generate a solid object from voxels (native name: FillMode).
FilterBackfaces - Static variable in class com.jme3.bullet.RayTestFlag
filter back faces (native value: kF_FilterBackfaces)
finalizeNative(long) - Static method in class com.jme3.bullet.collision.PhysicsCollisionObject
Finalize the identified btCollisionObject.
finalizeNative(long) - Static method in class com.jme3.bullet.joints.SoftPhysicsJoint
Finalize the btTypedConstraint.
findEnd(PhysicsBody) - Method in class com.jme3.bullet.joints.PhysicsJoint
Test whether the specified body is an end of this joint.
findIndex(CollisionShape) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Find the first child with the specified shape.
findInstance(long) - Static method in class com.jme3.bullet.collision.PhysicsCollisionObject
Find the collision object with the specified ID.
findOtherBody(PhysicsBody) - Method in class com.jme3.bullet.joints.PhysicsJoint
Access the remaining body of this joint.
findVvid(int) - Method in class jme3utilities.math.DistinctVectorValues
Find the ID of the indexed vector in the original buffer range.
finite(float, String) - Static method in class jme3utilities.Validate
Validate a finite single-precision value as a method argument.
finite(Vector3f, String) - Static method in class jme3utilities.Validate
Validate a finite Vector3f as a method argument.
finite(Vec3d, String) - Static method in class jme3utilities.Validate
Validate a finite Vec3d as a method argument.
firstAxis - Static variable in class jme3utilities.math.MyVector3f
index of the first (X) axis
firstToLower(String) - Static method in class jme3utilities.MyString
Convert the first character of the specified text to lower case.
firstValue - Static variable in class com.jme3.bullet.collision.Activation
lowest legal value, for range checks
Fixed - Enum constant in enum class com.jme3.bullet.MultiBodyJointType
fixed joint (native name: eFixed)
FloodFill - Enum constant in enum class com.jme3.bullet.FillMode
use a flood fill to distinguish inside from outside (native name: FLOOD_FILL)
FLT_EPSILON - Static variable in class com.jme3.math.FastMath
A "close to zero" double epsilon value for use
fluid - Static variable in class com.jme3.bullet.collision.PcoType
unused (native name: CO_HF_FLUID)
forwardAxisIndex() - Method in class com.jme3.bullet.objects.infos.VehicleController
Determine the index of the vehicle's forward axis.
forwardAxisIndex() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the index of this vehicle's forward axis.
fraction(double, String) - Static method in class jme3utilities.Validate
Validate a non-negative proper fraction as a method argument.
fraction(float, String) - Static method in class jme3utilities.Validate
Validate a non-negative proper fraction as a method argument.
freeUnusedObjects() - Static method in class com.jme3.bullet.NativePhysicsObject
Free any assigned native objects that are known to be unused.
frequency(IntBuffer, int, int, int) - Static method in class jme3utilities.math.MyBuffer
Count the number of times the specified value occurs in the specified IntBuffer range.
FRICTION_ANCHOR - Static variable in class com.jme3.bullet.collision.ContactPointFlag
contact has a friction anchor
fromAngleNormalAxis(float, Vector3f) - Method in class com.jme3.math.Quaternion
Sets the quaternion from the specified rotation angle and normalized axis of rotation.
fromAngles(double, double, double) - Method in class com.simsilica.mathd.Quatd
Builds a Quaternion from the Euler rotation angles (x,y,z) aka (pitch, yaw, roll).
fromAngles(float, float, float) - Method in class com.jme3.math.Quaternion
Sets the quaternion from the specified Tait-Bryan angles, applying the rotations in x-z-y extrinsic order or y-z'-x" intrinsic order.
fromAngles(float, float, float, Matrix3f) - Static method in class jme3utilities.math.MyMath
Sets a rotation matrix from the specified Tait-Bryan angles, applying the rotations in x-z-y extrinsic order or y-z'-x" intrinsic order.
fromAxes(Vector3f, Vector3f, Vector3f) - Method in class com.jme3.math.Matrix3f
Configures from the specified column vectors.
fromAxes(Vector3f, Vector3f, Vector3f) - Method in class com.jme3.math.Quaternion
Sets the quaternion from the specified orthonormal basis.
fromInputStream(InputStream) - Method in class vhacd.VHACDParameters
Read selected parameters from the specified InputStream.
fromInputStream(InputStream) - Method in class vhacd4.Vhacd4Parameters
Read all parameters from the specified InputStream.
fromRotationMatrix(float, float, float, float, float, float, float, float, float) - Method in class com.jme3.math.Quaternion
Sets the quaternion from a rotation matrix with the specified elements.
fromRotationMatrix(Matrix3f) - Method in class com.jme3.math.Quaternion
Sets the quaternion from the specified rotation matrix.
fromTransformMatrix(Matrix4f) - Method in class com.jme3.math.Transform
Sets the current instance from a transform matrix.

G

GearJoint - Class in com.jme3.bullet.joints
A joint that couples the angular velocities of two bodies, based on Bullet's btGearConstraint.
GearJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.joints.GearJoint
Instantiate a double-ended GearJoint with a 1:1 ratio.
GearJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, float) - Constructor for class com.jme3.bullet.joints.GearJoint
Instantiate a double-ended GearJoint with the specified gear ratio.
generateBasis(Vector3f, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVector3f
Generate an orthonormal basis that includes the specified vector.
generateBendingConstraints(int, SoftBodyMaterial) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Generate bending constraints based on hops in the adjacency graph.
generateClusters() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Generate one cluster per tetrahedron (or one per face if there are no tetrahedra).
generateClusters(int, int) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Generate clusters (K-mean).
generateIndexMap(FloatBuffer) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Create an index map to merge any mesh vertices that share the same position.
Generator - Class in jme3utilities.math.noise
Generate pseudo-random numbers, quaternions, vectors, and selections.
Generator() - Constructor for class jme3utilities.math.noise.Generator
Instantiate a pseudo-random generator with a seed likely to be unique.
Generator(long) - Constructor for class jme3utilities.math.noise.Generator
Instantiate a pseudo-random generator with the specified seed.
generic - Static variable in class com.jme3.bullet.collision.PcoType
default value, unused in Libbulletjme (native name: CO_COLLISION_OBJECT)
get() - Static method in class com.jme3.util.TempVars
Acquire an instance of the TempVar class.
get() - Method in class jme3utilities.lbj.IndexBuffer
Read an index from the current read/write position, then increment the position.
get(int) - Method in class com.jme3.math.Triangle
Accesses the location of the indexed vertex.
get(int) - Method in class com.jme3.math.Vector3f
Returns the indexed component.
get(int) - Method in class com.simsilica.mathd.Vec3d
Returns the indexed component.
get(int) - Method in class jme3utilities.lbj.IndexBuffer
Read an index from the specified buffer position.
get(int, int) - Method in class com.jme3.math.Matrix3f
Returns the element at the specified position.
get(MotorParam) - Method in class com.jme3.bullet.joints.motors.RotationMotor
Return the value of the specified parameter.
get(MotorParam, int) - Method in class com.jme3.bullet.joints.New6Dof
Return the specified parameter of the indexed degree of freedom.
get(MotorParam, Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Copy the specified parameter of this motor.
get(Cluster, int) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Read the specified parameter of the indexed cluster.
get(Sbcp) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Return the value of the specified parameter.
get(FloatBuffer, int, Vector3f) - Static method in class jme3utilities.math.MyBuffer
Read a Vector3f starting from the specified position.
get1() - Method in class com.jme3.math.Triangle
Accesses the location of the first vertex.
get2() - Method in class com.jme3.math.Triangle
Accesses the location of the 2nd vertex.
get3() - Method in class com.jme3.math.Triangle
Accesses the location of the 3rd vertex.
getAccumulatedImpulse() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return the accumulated impulse (native field: m_accumulatedImpulse).
getAccumulatedImpulse(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Copy the accumulated impulse (native field: m_accumulatedImpulse).
getAccuracy() - Method in class com.jme3.bullet.PhysicsSpace
Return the simulation accuracy: the time step used when maxSubSteps>0.
getACDMode() - Method in class vhacd.VHACDParameters
Return the decomposition mode (native field: m_mode).
getActivationState() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return this object's activation state (native field: m_activationState1).
getAlpha() - Method in class vhacd.VHACDParameters
Return the bias toward clipping along symmetry planes.
getAnchor(Vector3f) - Method in class com.jme3.bullet.joints.NewHinge
Determine the anchor location for body A.
getAnchor2(Vector3f) - Method in class com.jme3.bullet.joints.NewHinge
Determine the anchor location for body B.
getAngle() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's current rotation angle (native field: m_currentPosition).
getAngle1() - Method in class com.jme3.bullet.joints.NewHinge
Determine the rotation angle for axis1.
getAngle2() - Method in class com.jme3.bullet.joints.NewHinge
Determine the rotation angle for axis2.
getAngles(Vector3f) - Method in class com.jme3.bullet.joints.New6Dof
Calculate the constraint's rotation angles (native field: m_calculatedAxisAngleDiff).
getAngles(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Copy the joint's rotation angles.
getAngularDamping() - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's angular damping.
getAngularDamping() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's angular damping.
getAngularDamping() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Return the body's angular damping.
getAngularFactor(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the body's angular factors.
getAngularLowerLimit(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Copy the joint's lower limits for rotation on all 3 axes.
getAngularSleepingThreshold() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Return the body's angular-motion sleeping threshold.
getAngularUpperLimit(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Copy the joint's upper limits for rotation on all 3 axes.
getAngularVelocity(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's angular velocity.
getAngularVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's angular velocity.
getAngularVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the body's angular velocity.
getAngularVelocityDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the body's angular velocity.
getAngularVelocityLocal(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Calculate the body's angular velocity in its local coordinates.
getAnisotropicFriction(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy this object's anisotropic friction components (native field: m_anisotropicFriction).
getAppliedImpulse() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's applied impulse (native field: m_appliedImpulse).
getAppliedImpulse() - Method in class com.jme3.bullet.joints.Constraint
Determine the magnitude of the applied impulse.
getAppliedImpulse(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the applied impulse of the specified point (native field: m_appliedImpulse).
getAppliedImpulseLateral1() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's applied lateral impulse #1 (native field: m_appliedImpulseLateral1).
getAppliedImpulseLateral1(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the applied lateral impulse #1 of the specified point (native field: m_appliedImpulseLateral1).
getAppliedImpulseLateral2() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's applied lateral impulse #2 (native field: m_appliedImpulseLateral2).
getAppliedImpulseLateral2(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the applied lateral impulse #2 of the specified point (native field: m_appliedImpulseLateral2).
getAxis() - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Return the main (height) axis of the capsule.
getAxis() - Method in class com.jme3.bullet.collision.shapes.ConeCollisionShape
Return the main (height) axis of the cone.
getAxis() - Method in class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Return the main (height) axis of the cylinder.
getAxis(int, Vector3f) - Method in class com.jme3.bullet.joints.New6Dof
Calculate the indexed axis of the Constraint (native field: m_calculatedAxis).
getAxis1(Vector3f) - Method in class com.jme3.bullet.joints.NewHinge
Determine the direction of axis1.
getAxis2(Vector3f) - Method in class com.jme3.bullet.joints.NewHinge
Determine the direction of axis2.
getAxisA(Vector3f) - Method in class com.jme3.bullet.joints.GearJoint
Copy A body's axis of rotation.
getAxisB(Vector3f) - Method in class com.jme3.bullet.joints.GearJoint
Copy the B body's axis of rotation.
getAxle(Vector3f) - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's axis direction.
getBaseCollider() - Method in class com.jme3.bullet.MultiBody
Access the collider for the base.
getBaseShape() - Method in class com.jme3.bullet.collision.shapes.Convex2dShape
Access the base shape.
getBeta() - Method in class vhacd.VHACDParameters
Return the bias toward clipping along revolution axes (native field: m_beta).
getBiasFactor() - Method in class com.jme3.bullet.joints.HingeJoint
Read this joint's bias factor.
getBody(JointEnd) - Method in class com.jme3.bullet.joints.PhysicsJoint
Access the body at the specified end of this joint.
getBodyA() - Method in class com.jme3.bullet.joints.Constraint
Access the rigid body at the A end.
getBodyA() - Method in class com.jme3.bullet.joints.PhysicsJoint
Access the body at the joint's "A" end.
getBodyAId(long) - Static method in class com.jme3.bullet.collision.PersistentManifolds
Return the native ID of the first collision object (native field: m_body0).
getBodyB() - Method in class com.jme3.bullet.joints.Constraint
Access the rigid body at the B end.
getBodyB() - Method in class com.jme3.bullet.joints.PhysicsJoint
Access the body at the joint's "B" end.
getBodyBId(long) - Static method in class com.jme3.bullet.collision.PersistentManifolds
Return the native ID of the 2nd collision object (native field: m_body1).
getBrake() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's braking impulse (native field: m_brake).
getBreakingImpulseThreshold() - Method in class com.jme3.bullet.joints.Constraint
Determine the breaking impulse threshold.
getBroadphaseType() - Method in class com.jme3.bullet.CollisionSpace
Return the type of acceleration structure used for broadphase collision detection.
getBuffer() - Method in class jme3utilities.lbj.IndexBuffer
Access the buffer data.
getBvh() - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Access the bounding-value hierarchy.
getCcdMotionThreshold() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the continuous collision detection (CCD) motion threshold (native field: m_ccdMotionThreshold).
getCcdSquareMotionThreshold() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the squared motion threshold.
getCcdSweptSphereRadius() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the radius of the sphere used for continuous collision detection (CCD) (native field: m_ccdSweptSphereRadius).
getCenter(Vector3f) - Method in class com.jme3.bounding.BoundingBox
Return the location of the center.
getCFM() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Read the constraint force mixing coefficient (aka CFM).
getCharacterList() - Method in class com.jme3.bullet.PhysicsSpace
Enumerate physics characters that have been added to the space and not yet removed.
getClosestPoint(Vector3f, Vector3f) - Method in class com.jme3.math.Plane
Find the point in this plane that's nearest to the specified point.
getCollider() - Method in class com.jme3.bullet.MultiBodyLink
Access the collider for this link.
getCollideWithGroups() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the set of collision groups with which this object can collide.
getCollisionGroup() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision group of this object.
getCollisionLocation(Vector3f) - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the location where the wheel touches the ground.
getCollisionNormal(Vector3f) - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the normal direction where the wheel touches the ground.
getCollisionObject() - Method in class com.jme3.bullet.collision.PhysicsRayTestResult
Access the collision object that was hit.
getCollisionObject() - Method in class com.jme3.bullet.collision.PhysicsSweepTestResult
Access the collision object that was hit.
getCollisionShape() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Access the shape of the collision object.
getCollisionSpace() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Access the space where the collision object is added.
getCollisionSpace() - Static method in class com.jme3.bullet.CollisionSpace
Access the CollisionSpace associated with the current thread.
getCombinedFriction() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's combined friction, which is usually the product of the collision-object frictions (native field: m_combinedFriction).
getCombinedFriction(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the combined friction of the specified point, which is the product of the collision-object frictions (native field: m_combinedFriction).
getCombinedRestitution() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's combined restitution, which is usually the product of the collision-object restitutions (native field: m_combinedRestitution).
getCombinedRestitution(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the combined restitution of the specified point, which is the product of the collision-object restitutions (native field: m_combinedRestitution).
getCombinedRollingFriction() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's combined rolling friction (native field: m_combinedRollingFriction).
getCombinedRollingFriction(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the combined rolling friction of the specified point (native field: m_combinedRollingFriction).
getCombinedSpinningFriction() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's combined spinning friction (native field: m_combinedSpinningFriction).
getCombinedSpinningFriction(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the combined spinning friction of the specified point (native field: m_combinedSpinningFriction).
getConfiguration() - Method in class com.jme3.bullet.CollisionSpace
Access the tuning parameters.
getConstant() - Method in class com.jme3.math.Plane
getConstant returns the constant of the plane.
getConstraintType(long) - Static method in class com.jme3.bullet.joints.Constraint
Read the constraint type.
getContactDamping() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the contact damping (native field: m_contactDamping).
getContactMotion1(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the contact motion #1 of the specified point (native field: m_contactMotion1).
getContactMotion2(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the contact motion #2 of the specified point (native field: m_contactMotion2).
getContactProcessingThreshold() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the contact-processing threshold (native field: m_contactProcessingThreshold).
getContactStiffness() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the contact stiffness (native field: m_contactStiffness).
getController() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Access this vehicle's controller.
getControllerId() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine the ID of the btKinematicCharacterController.
getConvexHullDownSampling() - Method in class vhacd.VHACDParameters
Return the precision of the convex-hull generation process (native field: m_convexhullDownsampling).
getCurrentVehicleSpeedKmHour() - Method in class com.jme3.bullet.objects.infos.VehicleController
Determine the vehicle's speed in km/h.
getCurrentVehicleSpeedKmHour() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine this vehicle's forward velocity as of the previous simulation step.
getDamping() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's damping (native field: m_damping).
getDamping() - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Return this motor's damping (native field: m_damping).
getDamping() - Method in class com.jme3.bullet.joints.Point2PointJoint
Return the joint's damping ratio.
getDamping(int) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Return the damping of the indexed degree of freedom.
getDampingDirAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's damping for on-axis rotation between the limits.
getDampingDirLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's damping for on-axis translation between the limits.
getDampingLimAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's damping for on-axis rotation hitting the limits.
getDampingLimLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's damping for on-axis translation hitting the limits.
getDampingOrthoAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's damping for off-axis rotation.
getDampingOrthoLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's damping for off-axis translation.
getDeactivationDeadline() - Static method in class com.jme3.bullet.objects.PhysicsBody
Return the global deactivation deadline.
getDeactivationTime() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the deactivation time (native field: m_deactivationTime).
getDebugEnabled() - Method in class vhacd.VHACDParameters
Test whether debug output is enabled.
getDebugEnabled() - Method in class vhacd4.Vhacd4Parameters
Test whether debug output is enabled.
getDebugTriangles(CollisionShape, int) - Static method in class com.jme3.bullet.util.DebugShapeFactory
Generate vertex locations for triangles to visualize the specified collision shape.
getDefaultMargin() - Static method in class com.jme3.bullet.collision.shapes.CollisionShape
Return the default margin for new shapes that are neither capsules nor spheres.
getDeformableSpace() - Static method in class com.jme3.bullet.DeformableSpace
Access the DeformableSpace running on this thread.
getDeltaRotation() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine how much this wheel has turned since the last simulation step.
getDescriber() - Method in class jme3utilities.debug.Dumper
Access the Describer used by this dumper.
getDescriber() - Method in class jme3utilities.minie.PhysicsDumper
Access the Describer used by this Dumper.
getDirection(Vector3f) - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's suspension direction.
getDistance1() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's signed separation distance (native field: m_distance1).
getDistance1(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the separation distance of the specified point (native field: m_distance1).
getEnableMotor() - Method in class com.jme3.bullet.joints.HingeJoint
Test whether this joint's motor is enabled.
getEngineForce() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's engine force (native field: m_engineForce).
getEquilibriumPoint(int) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Return the equilibrium point of the indexed degree of freedom.
getERP() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's error-reduction parameter at the limits (native field: m_stopERP).
getERP() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Read the error-reduction parameter (aka ERP).
getERP(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Copy this motor's error-reduction parameters at the limits (native field: m_stopERP).
getExtent(Vector3f) - Method in class com.jme3.bounding.BoundingBox
Query extent.
getFallSpeed() - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's maximum fall speed (terminal velocity).
getFallSpeed() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's maximum fall speed (terminal velocity).
getFillMode() - Method in class vhacd4.Vhacd4Parameters
Return the algorithm that fills voxels to create a solid object (native field: m_fillMode).
getFlags() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact-point flags (native field: m_contactPointFlags).
getFlags(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the flags of the specified point (native field: m_contactPointFlags).
getForwardVector(Vector3f) - Method in class com.jme3.bullet.objects.infos.VehicleController
Determine the vehicle's forward direction.
getForwardVector(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine this vehicle's forward direction.
getFrameTransform(JointEnd, Transform) - Method in class com.jme3.bullet.joints.ConeJoint
Copy the joint's frame transform relative to the specified end.
getFrameTransform(JointEnd, Transform) - Method in class com.jme3.bullet.joints.HingeJoint
Copy the joint's frame transform relative to the specified end.
getFrameTransform(JointEnd, Transform) - Method in class com.jme3.bullet.joints.New6Dof
Copy the constraint's frame transform relative to the specified end (native fields: m_frameInA, m_frameInB).
getFrameTransform(JointEnd, Transform) - Method in class com.jme3.bullet.joints.SixDofJoint
Copy the joint's frame transform relative to the specified end.
getFrameTransform(JointEnd, Transform) - Method in class com.jme3.bullet.joints.SliderJoint
Copy the joint's frame transform relative to the specified end.
getFriction() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision object's friction parameter (native field: m_friction).
getFrictionSlip() - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Return the friction between tires and ground (native field: m_frictionSlip).
getFrictionSlip() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the initial friction for new wheels.
getFrictionSlip() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the friction between this wheel's tire and the ground (native field: m_frictionSlip).
getGhostObjectList() - Method in class com.jme3.bullet.CollisionSpace
Enumerate ghost objects that have been added to the space and not yet removed.
getGravity(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's gravitational acceleration.
getGravity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsBody
Copy this body's gravitational acceleration.
getGravity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's gravitational acceleration.
getGravity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the body's gravitational acceleration.
getGravity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy this body's gravitational acceleration.
getGravity(Vector3f) - Method in class com.jme3.bullet.PhysicsSpace
Copy the gravitational acceleration for newly-added bodies.
getGravityDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the body's gravitational acceleration.
getHalfExtents(Vector3f) - Method in class com.jme3.bullet.collision.shapes.Box2dShape
Copy the half extents of the rectangle.
getHalfExtents(Vector3f) - Method in class com.jme3.bullet.collision.shapes.BoxCollisionShape
Copy the half extents of the box.
getHalfExtents(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Copy the half extents of the cylinder.
getHalfExtents(Vector3f) - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Calculate the unscaled half extents of the hull.
getHalfExtents(Vector3f) - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Calculate the unscaled half extents of the simplex.
getHeight() - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Return the height of the cylindrical portion.
getHeight() - Method in class com.jme3.bullet.collision.shapes.ConeCollisionShape
Return the height of the cone.
getHeight() - Method in class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Return the height of the cylinder.
getHeight() - Method in class com.jme3.bullet.collision.shapes.SphericalSegment
Return the height of the segment.
getHingeAngle() - Method in class com.jme3.bullet.joints.HingeJoint
Read the hinge angle.
getHitFraction() - Method in class com.jme3.bullet.collision.PhysicsRayTestResult
Read the fraction of the ray's total length.
getHitFraction() - Method in class com.jme3.bullet.collision.PhysicsSweepTestResult
Return the fraction of the way between the transforms (from=0, to=1, ≥0, ≤1)
getHitNormalLocal(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsRayTestResult
Copy the normal vector at the point of contact.
getHitNormalLocal(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsSweepTestResult
Copy the normal vector at the point of contact.
getImpulseClamp() - Method in class com.jme3.bullet.joints.Point2PointJoint
Return the joint's impulse clamp.
getIndex() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the index of this wheel, based on creation order.
getIndex0() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the triangle index in the shape of object A at the point of contact (native field: m_index0).
getIndex0(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the triangle index from the shape of object A at the specified point of contact (native field: m_index0).
getIndex1() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the triangle index in the shape of object B at the point of contact (native field: m_index1).
getIndex1(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the triangle index from the shape of object B at the specified point of contact (native field: m_index1).
getIndexBuffer() - Method in interface jme3utilities.lbj.Mesh
Access the index buffer.
getInternalType(long) - Static method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the type of this object.
getInverseInertiaLocal(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the principal (diagonal) elements of the inverse inertia tensor in the body's local coordinates.
getInverseInertiaWorld(Matrix3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Compute the inverse inertia tensor in physics-space coordinates.
getJointList() - Method in class com.jme3.bullet.PhysicsSpace
Enumerate physics joints that have been added to the space and not yet removed.
getJointMap() - Method in class com.jme3.bullet.PhysicsSpace
Access the map from native IDs to physics joints.
getJumpSpeed() - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's jump speed.
getJumpSpeed() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's jump speed.
getLateralFrictionDir1(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the lateral friction direction #1 of the specified point (native field: m_lateralFrictionDir1).
getLateralFrictionDir1(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's lateral friction direction #1 (native field: m_lateralFrictionDir1).
getLateralFrictionDir2(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the lateral friction direction #2 of the specified point (native field: m_lateralFrictionDir2).
getLateralFrictionDir2(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's lateral friction direction #2 (native field: m_lateralFrictionDir2).
getLifeTime() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's lifetime (native name: m_lifeTime).
getLifeTime(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the lifetime of the specified point (native name: m_lifeTime).
getLimitSoftness() - Method in class com.jme3.bullet.joints.HingeJoint
Read this joint's limit softness.
getLimitSoftness() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's limit softness (native field: m_limitSoftness).
getLimitSoftness() - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Return this motor's limit softness (native field: m_limitSoftness).
getLinearDamping() - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's linear damping.
getLinearDamping() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's linear damping.
getLinearDamping() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Return the body's linear damping.
getLinearFactor(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the body's linear factors.
getLinearLowerLimit(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Copy the joint's lower limits for translation on all 3 axes.
getLinearSleepingThreshold() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Return the body's linear-motion sleeping threshold.
getLinearUpperLimit(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Copy the joint's upper limits for translation on all 3 axes.
getLinearVelocity(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the linear velocity of the character's center.
getLinearVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine the linear velocity of this character's center.
getLinearVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the linear velocity of the body's center of mass.
getLinearVelocity(Vector3f) - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Copy the rigid velocity.
getLinearVelocityDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Copy the linear velocity of the body's center of mass.
getLink(int) - Method in class com.jme3.bullet.MultiBody
Access the index link of this MultiBody.
getLocalPointA(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the location of the specified point in the local coordinates of object A (native name: m_localPointA).
getLocalPointA(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's location in the local coordinates of object A (native name: m_localPointA).
getLocalPointB(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the location of the specified point in the local coordinates of object B (native name: m_localPointB).
getLocalPointB(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's location in the local coordinates of object B (native name: m_localPointB).
getLocation(Vector3f) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Copy the location to a Vector3f.
getLocation(Vector3f) - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the location where the suspension connects to the chassis.
getLocationDp(Vec3d) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Copy the location to a Vector3d.
getLowerAngLimit() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's lower limit for on-axis rotation.
getLowerLimit() - Method in class com.jme3.bullet.joints.HingeJoint
Read the lower limit of the hinge angle.
getLowerLimit() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's constraint lower limit (native field: m_loLimit).
getLowerLimit(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Copy this motor's constraint lower limits (native field: m_lowerLimit).
getLowerLinLimit() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's lower limit for on-axis translation.
getMargin() - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Return the collision margin of the shape.
getMargin() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Return the (copied) collision margin of the shape.
getMargin() - Method in class com.jme3.bullet.collision.shapes.MinkowskiSum
Return the collision margin of this shape.
getMargin() - Method in class com.jme3.bullet.collision.shapes.SphereCollisionShape
Return the collision margin of the shape.
getMass() - Method in class com.jme3.bullet.objects.PhysicsBody
Determine the total mass of this body.
getMass() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Return the body's mass.
getMass() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Determine the total mass of this body.
getMax(Vector3f) - Method in class com.jme3.bounding.BoundingBox
Determine the maximum coordinate value for each axis.
getMaxAngMotorForce() - Method in class com.jme3.bullet.joints.SliderJoint
Read the maximum force of the rotation motor.
getMaxConcavity() - Method in class vhacd.VHACDParameters
Return the maximum concavity (native field: m_concavity).
getMaxHulls() - Method in class vhacd4.Vhacd4Parameters
Return the maximum number of convex hulls (native field: m_maxConvexHulls).
getMaxLimitForce() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return the limit maximum force (native field: m_maxLimitForce).
getMaxLinMotorForce() - Method in class com.jme3.bullet.joints.SliderJoint
Read the maximum force of the translation motor.
getMaxMotorForce() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's maximum force for normal conditions (native field: m_maxMotorForce).
getMaxMotorForce(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Copy this motor's maximum motor forces for normal conditions (native field: m_maxMotorForce).
getMaxMotorImpulse() - Method in class com.jme3.bullet.joints.HingeJoint
Read the motor's maximum impulse.
getMaxPenetrationDepth() - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's maximum penetration depth.
getMaxPenetrationDepth() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's maximum penetration depth.
getMaxRecursion() - Method in class vhacd4.Vhacd4Parameters
Return the maximum recursion depth (native field: m_maxRecursionDepth).
getMaxSlope() - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's maximum slope angle.
getMaxSlope() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's maximum slope angle.
getMaxSuspensionForce() - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Return the maximum force exerted by each wheel's suspension (native field: m_maxSuspensionForce).
getMaxSuspensionForce() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the initial maximum suspension force for new wheels.
getMaxSuspensionForce() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the maximum force exerted by this wheel's suspension (native field: m_maxSuspensionForce).
getMaxSuspensionTravelCm() - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Determine the maximum travel distance for each wheel's suspension (native field: m_maxSuspensionTravelCm).
getMaxSuspensionTravelCm() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the initial maximum suspension travel distance for new wheels.
getMaxSuspensionTravelCm() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the maximum travel distance for this wheel's suspension (native field: m_maxSuspensionTravelCm).
getMaxVerticesPerHull() - Method in class vhacd.VHACDParameters
Return the maximum number of vertices per convex hull (native field: m_maxNumVerticesPerCH).
getMaxVerticesPerHull() - Method in class vhacd4.Vhacd4Parameters
Return the maximum number of vertices per convex hull (native field: m_maxNumVerticesPerCH).
getMin(Vector3f) - Method in class com.jme3.bounding.BoundingBox
Determine the minimum coordinate value for each axis.
getMinEdgeLength() - Method in class vhacd4.Vhacd4Parameters
Return the minimum edge length (native field: m_minEdgeLength).
getMinVolumePerHull() - Method in class vhacd.VHACDParameters
Return the minimum volume for added vertices (native field: m_minVolumePerCH).
getMotionState() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Access the body's motion state.
getMotorTargetVelocity() - Method in class com.jme3.bullet.joints.HingeJoint
Read the motor's target velocity.
getMultiBody() - Method in class com.jme3.bullet.MultiBodyLink
Access the MultiBody that contains this link.
getMultiBody() - Method in class com.jme3.bullet.objects.MultiBodyCollider
Access the MultiBody that contains this collider.
getMultiBodyList() - Method in class com.jme3.bullet.MultiBodySpace
Enumerate multibodies that have been added to this space and not yet removed.
getMultiBodySpace() - Static method in class com.jme3.bullet.MultiBodySpace
Access the MultiBodySpace running on this thread.
getNormal() - Method in class com.jme3.math.Plane
getNormal retrieves the normal of the plane.
getNormal() - Method in class com.jme3.math.Triangle
Accesses the stored normal, updating it if it is null.
getNormalCFM() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's constraint-force mixing parameter for normal conditions (native field: m_normalCFM).
getNormalCFM(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Copy this motor's constraint-force mixing parameters for normal conditions (native field: m_normalCFM).
getNormalsData() - Method in interface jme3utilities.lbj.Mesh
Access the normals data buffer.
getNormalWorldOnB(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the normal on object B of the specified point in physics-space coordinates (native name: m_normalWorldOnB).
getNormalWorldOnB(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's normal on object B in physics-space coordinates (native name: m_normalWorldOnB).
getNumWheels() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Count the number of wheels on this vehicle.
getObjectA() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Access collision object A.
getObjectB() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Access collision object B.
getOffset(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Return the offset of the constraint frames (native field: m_currentLinearDiff).
getOrientation(Matrix3f) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Copy the orientation to a Matrix3f.
getOrientation(Quaternion) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Copy the orientation to a Quaternion.
getOrientationMatrixDp(Matrix3d) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Copy the orientation to a Matrix3d.
getOrientationQuaternionDp(Quatd) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Copy the orientation to a Quatd.
getOs() - Method in enum class com.jme3.system.Platform
Returns the operating system of this platform.
getOverlapping(int) - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Access an overlapping collision object by its position in the list.
getOverlappingCount() - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Count how many collision objects this object overlaps.
getOverlappingObjects() - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Update and access a list of overlapping objects.
getOverrideIterations() - Method in class com.jme3.bullet.joints.Constraint
Determine the number of iterations used to solve this Constraint.
getParentLink() - Method in class com.jme3.bullet.MultiBodyLink
Determine the parent of this link.
getPartId0() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the part index in the shape of object A at the point of contact (native field: m_partId0).
getPartId0(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the part index from the shape of object A at the specified point of contact (native field: m_partId0).
getPartId1() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the part index in the shape of object B at the point of contact (native field: m_partId1).
getPartId1(long) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Return the part index from the shape of object B at the specified point of contact (native field: m_partId1).
getPCA() - Method in class vhacd.VHACDParameters
Test whether to normalize the mesh (native field: m_pca).
getPcoList() - Method in class com.jme3.bullet.CollisionSpace
Enumerate collision objects that have been added to the space and not yet removed.
getPcoList() - Method in class com.jme3.bullet.DeformableSpace
Enumerate collision objects that have been added to this space and not yet removed.
getPcoList() - Method in class com.jme3.bullet.MultiBodySpace
Enumerate collision objects that have been added to this space and not yet removed.
getPcoList() - Method in class com.jme3.bullet.PhysicsSoftSpace
Enumerate collision objects that have been added to this space and not yet removed.
getPcoList() - Method in class com.jme3.bullet.PhysicsSpace
Enumerate collision objects that have been added to the space and not yet removed.
getPhysicsLocation(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Locate the collision object's center.
getPhysicsLocation(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Locate the center of this body's axis-aligned bounding box.
getPhysicsLocationDp(Vec3d) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Locate the collision object's center in double precision.
getPhysicsLocationDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Locate the center of this body's axis-aligned bounding box.
getPhysicsRotation(Quaternion) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy the orientation (rotation) of the collision object to a Quaternion.
getPhysicsRotation(Quaternion) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the orientation (rotation) of this body to a Quaternion.
getPhysicsRotationDp(Quatd) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy the orientation (rotation) of this object to a Quatd.
getPhysicsRotationDp(Quatd) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the orientation (rotation) of this body to a Quatd.
getPhysicsRotationMatrix(Matrix3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy the orientation of the collision object (the basis of its local coordinate system) to a Matrix3f.
getPhysicsRotationMatrix(Matrix3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the orientation of this body (the basis of its local coordinate system) to a Matrix3f.
getPhysicsRotationMatrixDp(Matrix3d) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy the orientation of the collision object (the basis of its local coordinate system) to a Matrix3d.
getPhysicsRotationMatrixDp(Matrix3d) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the orientation of this body (the basis of its local coordinate system) to a Matrix3d.
getPhysicsSpace() - Method in class com.jme3.bullet.joints.PhysicsJoint
Access the PhysicsSpace where this joint is added.
getPhysicsSpace() - Static method in class com.jme3.bullet.PhysicsSpace
Access the PhysicsSpace running on this thread.
getPivot(JointEnd, Vector3f) - Method in class com.jme3.bullet.joints.Constraint
Copy the location of the specified connection point in the specified body.
getPivotA(Vector3f) - Method in class com.jme3.bullet.joints.Constraint
Copy the location of the connection point in the body at the A end.
getPivotB(Vector3f) - Method in class com.jme3.bullet.joints.Constraint
Copy the location of the connection point in the body at the B end.
getPivotInA(Vector3f) - Method in class com.jme3.bullet.joints.Point2PointJoint
Locate the pivot in A's scaled local coordinates.
getPivotInB(Vector3f) - Method in class com.jme3.bullet.joints.Point2PointJoint
Locate the pivot in B's scaled local coordinates.
getPivotOffset(Vector3f) - Method in class com.jme3.bullet.joints.New6Dof
Copy the constraint's pivot offset (native field: m_calculatedLinearDiff).
getPivotOffset(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Copy the joint's pivot offset.
getPlane() - Method in class com.jme3.bullet.collision.shapes.PlaneCollisionShape
Copy the defining plane.
getPlaneDownSampling() - Method in class vhacd.VHACDParameters
Return the granularity of the search (native field: m_planeDownsampling).
getPlatform() - Static method in class com.jme3.system.JmeSystem
Determine which Platform (operating system and architecture) the application is running on.
getPointId(long, int) - Static method in class com.jme3.bullet.collision.PersistentManifolds
Return the indexed btManifoldPoint in the specified manifold.
getPositionsData() - Method in interface jme3utilities.lbj.Mesh
Access the positions data buffer.
getPositionWorldOnA(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the location of the specified point on object A in physics-space coordinates (native field: m_positionWorldOnA).
getPositionWorldOnA(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's location on object A in physics-space coordinates (native field: m_positionWorldOnA).
getPositionWorldOnADp(long, Vec3d) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the location of the specified point on object A in physics-space coordinates (native field: m_positionWorldOnA).
getPositionWorldOnB(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the location of the specified point on object B in physics-space coordinates (native field: m_positionWorldOnB).
getPositionWorldOnB(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Return the contact point's location on object B in physics-space coordinates (native field: m_positionWorldOnB).
getPositionWorldOnBDp(long, Vec3d) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine the location of the specified point on object B in physics-space coordinates (native field: m_positionWorldOnB).
getRadius() - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Return the radius of the capsule.
getRadius() - Method in class com.jme3.bullet.collision.shapes.ConeCollisionShape
Return the radius of the cone's base.
getRadius() - Method in class com.jme3.bullet.collision.shapes.SphereCollisionShape
Return the radius of the sphere.
getRadius() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the radius of this wheel (native field: m_wheelsRadius).
getRadius(int) - Method in class com.jme3.bullet.collision.shapes.MultiSphere
Return the radius of the indexed sphere.
getRatio() - Method in class com.jme3.bullet.joints.GearJoint
Get the gear ratio.
getRayTestFlags() - Method in class com.jme3.bullet.CollisionSpace
Return the flags used in ray tests (native field: m_flags).
getRelaxationFactor() - Method in class com.jme3.bullet.joints.HingeJoint
Read this joint's relaxation factor.
getRestitution() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision object's restitution (bounciness) (native field: m_restitution).
getRestitution() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's restitution at the limits (native field: m_bounce).
getRestitution() - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Return this motor's restitution at the limits (native field: m_restitution).
getRestitutionDirAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's restitution for on-axis rotation between the limits.
getRestitutionDirLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's restitution for on-axis translation between the limits.
getRestitutionLimAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's restitution for on-axis rotation hitting the limits.
getRestitutionLimLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's restitution for on-axis translation hitting the limits.
getRestitutionOrthoAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's restitution for off-axis rotation.
getRestitutionOrthoLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's restitution for off-axis translation.
getRestLength() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the rest length of this wheel (native field: m_suspensionRestLength1).
getRigidBody() - Method in class com.jme3.bullet.joints.Anchor
Access the rigid body at the B end.
getRigidBodyList() - Method in class com.jme3.bullet.PhysicsSpace
Enumerate rigid bodies (including vehicles) that have been added to this space and not yet removed.
getRollInfluence() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's roll influence (native field: m_rollInfluence).
getRollingFriction() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return this object's rolling friction (native field: m_rollingFriction).
getRotation() - Method in class com.jme3.math.Transform
Returns the rotation component.
getRotation() - Method in class com.jme3.math.TransformDp
Accesses the rotation component.
getRotationalLimitMotor(int) - Method in class com.jme3.bullet.joints.SixDofJoint
Access the indexed RotationalLimitMotor of this joint, the motor which influences rotation around the indexed axis.
getRotationAngle() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the total rotation of this wheel (native field: m_rotation).
getRotationMatrix(JointEnd, Matrix3f) - Method in class com.jme3.bullet.joints.New6Dof
Copy the orientation of the constraint in the specified end's coordinate system.
getRotationMotor(int) - Method in class com.jme3.bullet.joints.New6Dof
Access the indexed RotationMotor of this constraint, the motor which influences rotation around the indexed axis.
getRotationOrder() - Method in class com.jme3.bullet.joints.New6Dof
Return the order in which axis rotations are applied (native field: m_rotateOrder).
getScale() - Method in class com.jme3.math.Transform
Returns the scaling component.
getScale() - Method in class com.jme3.math.TransformDp
Accesses the scaling component.
getScale(Vector3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy the scale of this object.
getScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Copy the scale factors.
getScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Copy the scale factors.
getScale(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the scale factors of this object.
getScaleDp(Vec3d) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Copy the scale factors.
getShape() - Method in class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Access the base shape.
getShapeA() - Method in class com.jme3.bullet.collision.shapes.MinkowskiSum
Access the first base shape.
getShapeB() - Method in class com.jme3.bullet.collision.shapes.MinkowskiSum
Access the 2nd base shape.
getShapeType() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Return the encoded type of the shape.
getShapeType(long) - Static method in class com.jme3.bullet.collision.shapes.CollisionShape
Return the type of this shape.
getSkidInfo() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine to what extent the wheel is skidding (for skid sounds/smoke etcetera).
getSoftBody() - Method in class com.jme3.bullet.joints.Anchor
Access the soft body at the A end.
getSoftBodyA() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Access the soft body at the A end.
getSoftBodyB() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Access the soft body at the B end.
getSoftBodyList() - Method in class com.jme3.bullet.DeformableSpace
Enumerate soft bodies that have been added to this space and not yet removed.
getSoftBodyList() - Method in class com.jme3.bullet.PhysicsSoftSpace
Enumerate soft bodies that have been added to this space and not yet removed.
getSoftConfig() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Access the SoftBodyConfig of this body.
getSoftMaterial() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Access the Material of this body.
getSoftnessDirAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's softness for on-axis rotation between the limits.
getSoftnessDirLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's softness for on-axis translation between the limits.
getSoftnessLimAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's softness for on-axis rotation hitting the limits.
getSoftnessLimLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's softness for on-axis translation hitting the limits.
getSoftnessOrthoAng() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's softness for off-axis rotation.
getSoftnessOrthoLin() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's softness for off-axis translation.
getSoftSpace() - Static method in class com.jme3.bullet.PhysicsSoftSpace
Access the PhysicsSoftSpace running on this thread.
getSolverInfo() - Method in class com.jme3.bullet.PhysicsSpace
Access parameters used by the contact-and-constraint solver.
getSolverType() - Method in class com.jme3.bullet.PhysicsSpace
Return the type of contact-and-constraint solver in use.
getSpinningFriction() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return this object's spinning friction (native field: m_spinningFriction).
getSplit() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Return the split.
getSquaredSpeed() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Calculate the squared speed of the body.
getSteerAngle() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's steering angle (native field: m_steering).
getStepHeight() - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's step height.
getStepHeight() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's step height.
getStiffness(int) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Return the spring stiffness of the indexed degree of freedom.
getStopCFM() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's constraint-force mixing parameter at the limits (native field: m_stopCFM).
getStopCFM(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Copy this motor's constraint-force mixing parameters at the limits (native field: m_stopCFM).
getSubmesh(int) - Method in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Access the specified submesh.
getSubmesh(int) - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Access the specified submesh.
getSubmesh(int) - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Access the specified submesh.
getSuspensionCompression() - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Return the suspension damping when compressed (native field: m_suspensionCompression).
getSuspensionCompression() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the initial damping (when the suspension is compressed) for new wheels.
getSuspensionDamping() - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Return the suspension damping when expanded (native field: m_suspensionDamping).
getSuspensionDamping() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the initial damping (when the suspension is expanded) for new wheels.
getSuspensionLength() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the length of this wheel's suspension (native field: m_suspensionLength).
getSuspensionStiffness() - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Return the suspension stiffness (native field: m_suspensionStiffness).
getSuspensionStiffness() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the initial suspension stiffness for new wheels.
getSuspensionStiffness() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine the stiffness of this wheel's suspension (native field: m_suspensionStiffness).
getSwingSpan1() - Method in class com.jme3.bullet.joints.ConeJoint
Return the span of the first swing axis.
getSwingSpan2() - Method in class com.jme3.bullet.joints.ConeJoint
Return the span of the 2nd swing axis.
getTargetAngMotorVelocity() - Method in class com.jme3.bullet.joints.SliderJoint
Read the velocity target of the rotation motor.
getTargetLinMotorVelocity() - Method in class com.jme3.bullet.joints.SliderJoint
Read the velocity target of the translation motor.
getTargetVelocity() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's target velocity (native field: m_targetVelocity).
getTargetVelocity(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Copy this motor's target velocity (native field: m_targetVelocity).
getTau() - Method in class com.jme3.bullet.joints.Point2PointJoint
Return the joint's tau value.
getTransform(Transform) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy the coordinate transform of this object, including the scale of its shape.
getTransformDp(TransformDp) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Copy the coordinate transform of this object, including the scale of its shape.
getTranslation() - Method in class com.jme3.math.Transform
Returns the translation component.
getTranslation() - Method in class com.jme3.math.TransformDp
Accesses the translation component.
getTranslationalLimitMotor() - Method in class com.jme3.bullet.joints.SixDofJoint
Access the TranslationalLimitMotor of this joint, the motor which influences translation on all 3 axes.
getTranslationMotor() - Method in class com.jme3.bullet.joints.New6Dof
Access the TranslationMotor of this Constraint, the motor which influences translation on all 3 axes.
getTuning() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Access the tuning parameters applied when a wheel is created.
getTwistSpan() - Method in class com.jme3.bullet.joints.ConeJoint
Return the span of the twist (local X) axis.
getUpDirection(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's "up" direction.
getUpDirection(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine this character's "up" direction.
getUpperAngLimit() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's upper limit for on-axis rotation.
getUpperLimit() - Method in class com.jme3.bullet.joints.HingeJoint
Read the upper limit of the hinge angle.
getUpperLimit() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Return this motor's constraint upper limit (native field: m_hiLimit).
getUpperLimit(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Copy this motor's constraint upper limits (native field: m_upperLimit).
getUpperLinLimit() - Method in class com.jme3.bullet.joints.SliderJoint
Read the joint's upper limit for on-axis translation.
getUserObject() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Access the "user" of this collision object.
getVehicleId() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Used internally.
getVehicleList() - Method in class com.jme3.bullet.PhysicsSpace
Enumerate physics vehicles that have been added to the space and not yet removed.
getVolumePercentError() - Method in class vhacd4.Vhacd4Parameters
Return the tolerance for the percent difference between the voxel volume and the volume of the hull (native field: m_minimumVolumePercentErrorAllowed).
getVoxelResolution() - Method in class vhacd.VHACDParameters
Return the maximum number of voxels generated during the voxelization stage (native field: m_resolution).
getVoxelResolution() - Method in class vhacd4.Vhacd4Parameters
Return the maximum number of voxels generated during the voxelization stage (native field: m_resolution).
getW() - Method in class com.jme3.math.Quaternion
Returns the W (real) component.
getWalkDirection(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Determine the character's walk offset.
getWalkDirection(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Determine the character's walk offset.
getWheel(int) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Access the indexed wheel of this vehicle.
getWheelsDampingCompression() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's damping when the suspension is compressed (native field: m_wheelsDampingCompression).
getWheelsDampingRelaxation() - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's damping when the suspension is expanded (native field: m_wheelsDampingRelaxation).
getWheelWorldLocation(Vector3f) - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's location.
getWheelWorldRotation(Quaternion) - Method in class com.jme3.bullet.objects.VehicleWheel
Determine this wheel's orientation.
getWorldInfo() - Method in class com.jme3.bullet.DeformableSpace
Access the parameters applied when soft bodies are added to this space.
getWorldInfo() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Access the world info.
getWorldInfo() - Method in class com.jme3.bullet.PhysicsSoftSpace
Access the parameters applied when soft bodies are added to this space.
getWorldMax(Vector3f) - Method in class com.jme3.bullet.CollisionSpace
Copy the maximum coordinate values for the space.
getWorldMin(Vector3f) - Method in class com.jme3.bullet.CollisionSpace
Copy the minimum coordinate values for the space.
getWorldType(long) - Static method in class com.jme3.bullet.PhysicsSpace
Determine the type of the underlying btDynamicsWorld.
getX() - Method in class com.jme3.math.Quaternion
Returns the X component.
getXExtent() - Method in class com.jme3.bounding.BoundingBox
Determine the X-axis distance between the center and the boundary.
getY() - Method in class com.jme3.math.Quaternion
Returns the Y component.
getYExtent() - Method in class com.jme3.bounding.BoundingBox
Determine the Y-axis distance between the center and the boundary.
getZ() - Method in class com.jme3.math.Quaternion
Returns the Z component.
getZExtent() - Method in class com.jme3.bounding.BoundingBox
Determine the Z-axis distance between the center and the boundary.
ghost - Static variable in class com.jme3.bullet.collision.PcoType
value for a PhysicsGhostObject (native name: CO_GHOST_OBJECT)
GImpactCollisionShape - Class in com.jme3.bullet.collision.shapes
A mesh collisions shape based on Bullet's btGImpactMeshShape.
GImpactCollisionShape(CompoundMesh, Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Instantiate a shape based on the specified CompoundMesh and offset.
GImpactCollisionShape(IndexedMesh...) - Constructor for class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Instantiate a shape based on the specified native mesh(es).
GjkRaytest - Static variable in class com.jme3.bullet.RayTestFlag
use the GJK algorithm for ray-versus-convex intersection (native value: kF_UseGjkConvexCastRaytest)
globalCfm() - Method in class com.jme3.bullet.SolverInfo
Determine the global constraint-force mixing parameter (native field: m_globalCfm).

H

HALF_PI - Static variable in class com.jme3.math.FastMath
The value PI/2 as a float.
halfExtents(Vector3f) - Method in class jme3utilities.math.RectangularSolid
Determine the half extents of the solid.
HAS_COLLISION_SOUND_TRIGGER - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag not supported by Libbulletjme
HAS_CONTACT_CFM - Static variable in class com.jme3.bullet.collision.ContactPointFlag
contact has a constraint-force modifier
HAS_CONTACT_ERP - Static variable in class com.jme3.bullet.collision.ContactPointFlag
contact has an error-reduction parameter
HAS_CONTACT_STIFFNESS_DAMPING - Static variable in class com.jme3.bullet.collision.CollisionFlag
indicates that contact damping and/or contact stiffness have been set
HAS_CUSTOM_DEBUG_RENDERING_COLOR - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag not supported by Libbulletjme
HAS_FRICTION_ANCHOR - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag not supported by Libbulletjme
hasAnisotropicFriction(int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Test whether the collision object has anisotropic friction.
hasAssignedNativeObject() - Method in class com.jme3.bullet.NativePhysicsObject
Test whether a native object is assigned to this instance.
hasClosest(CollisionShape, CollisionShape) - Method in class com.jme3.bullet.CollisionSpace
Test whether a nontrivial closest-points algorithm is registered for the specified collision shapes.
hasContact(CollisionShape, CollisionShape) - Method in class com.jme3.bullet.CollisionSpace
Test whether a nontrivial contact-points algorithm is registered for the specified collision shapes.
hasFixedBase() - Method in class com.jme3.bullet.MultiBody
Test whether this MultiBody has a fixed base.
hashCode() - Method in class com.jme3.bullet.NativePhysicsObject
Return the hash code for this instance.
hashCode() - Method in class com.jme3.math.Matrix3f
Returns a hash code.
hashCode() - Method in class com.jme3.math.Matrix4f
Returns a hash code.
hashCode() - Method in class com.jme3.math.Quaternion
Returns a hash code.
hashCode() - Method in class com.jme3.math.Transform
Returns a hash code.
hashCode() - Method in class com.jme3.math.TransformDp
Returns a hash code.
hashCode() - Method in class com.jme3.math.Vector3f
Returns a hash code.
hashCode() - Method in class com.simsilica.mathd.Matrix3d
Returns a hash code.
hashCode() - Method in class com.simsilica.mathd.Quatd
Returns a hash code.
hashCode() - Method in class com.simsilica.mathd.Vec3d
Returns a hash code.
hashCode() - Method in class jme3utilities.math.IntPair
Generate the hash code for this pair.
hashCode() - Method in class vhacd.VHACDParameters
Generate the hash code for this instance.
hashCode() - Method in class vhacd4.Vhacd4Parameters
Generate the hash code for this instance.
height() - Method in class com.jme3.bullet.collision.shapes.ConicalFrustum
Return the height of the frustum.
HeightfieldCollisionShape - Class in com.jme3.bullet.collision.shapes
A collision shape for terrain defined by a matrix of height values, based on Bullet's btHeightfieldTerrainShape.
HeightfieldCollisionShape(float[]) - Constructor for class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
Instantiate a square shape for the specified array of heights.
HeightfieldCollisionShape(float[], Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
Instantiate a square shape for the specified height array and scale vector.
HeightfieldCollisionShape(int, int, float[], Vector3f, int, boolean, boolean, boolean, boolean) - Constructor for class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
Instantiate a rectangular shape for the specified parameters.
highResolution - Static variable in class com.jme3.bullet.util.DebugShapeFactory
specify high-resolution debug meshes for convex shapes (up to 256 vertices) and zero-margin debug meshes for concave shapes
highResolution2 - Static variable in class com.jme3.bullet.util.DebugShapeFactory
specify high-resolution debug meshes for convex shapes (up to 256 vertices) and actual-margin debug meshes for concave shapes
HingeJoint - Class in com.jme3.bullet.joints
A single degree-of-freedom joint based on Bullet's btHingeConstraint.
HingeJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.joints.HingeJoint
Instantiate a double-ended HingeJoint.
HingeJoint(PhysicsRigidBody, Vector3f, Vector3f, Vector3f, Vector3f, JointEnd) - Constructor for class com.jme3.bullet.joints.HingeJoint
Instantiate a single-ended HingeJoint.
HullCollisionShape - Class in com.jme3.bullet.collision.shapes
A convex-hull collision shape based on Bullet's btConvexHullShape.
HullCollisionShape(float...) - Constructor for class com.jme3.bullet.collision.shapes.HullCollisionShape
Instantiate a shape based on the specified array of coordinates.
HullCollisionShape(Vector3f...) - Constructor for class com.jme3.bullet.collision.shapes.HullCollisionShape
Instantiate a shape based on the specified array of locations.
HullCollisionShape(FloatBuffer) - Constructor for class com.jme3.bullet.collision.shapes.HullCollisionShape
Instantiate a shape based on a flipped buffer containing coordinates.
HullCollisionShape(Collection<Vector3f>) - Constructor for class com.jme3.bullet.collision.shapes.HullCollisionShape
Instantiate a shape based on the specified collection of locations.
HullCollisionShape(RectangularSolid) - Constructor for class com.jme3.bullet.collision.shapes.HullCollisionShape
Instantiate an 8-vertex shape to match the specified rectangular solid.
HullCollisionShape(VHACDHull) - Constructor for class com.jme3.bullet.collision.shapes.HullCollisionShape
Instantiate a shape based on a VHACDHull.
HullCollisionShape(Vhacd4Hull) - Constructor for class com.jme3.bullet.collision.shapes.HullCollisionShape
Instantiate a shape based on a Vhacd4Hull.
hypotenuse(float...) - Static method in class jme3utilities.math.MyMath
Return the root sum of squares of some single-precision values.
hypotenuseDouble(double...) - Static method in class jme3utilities.math.MyMath
Return the root sum of squares of some double-precision values.

I

IDENTITY - Static variable in class com.jme3.math.Matrix3f
Shared instance of the identity matrix (diagonals = 1, other elements = 0).
IDENTITY - Static variable in class com.jme3.math.Quaternion
Shared instance of the identity quaternion (0, 0, 0, 1).
IDENTITY - Static variable in class com.jme3.math.Transform
Shared instance of the identity transform.
ignores(PhysicsCollisionObject) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Test whether the specified collision object is in the current collision object's ignore list.
Ignores - Enum constant in enum class jme3utilities.minie.DumpFlags
ignored objects in collision objects
indentIncrement() - Method in class jme3utilities.debug.Dumper
Return the indent increment.
index() - Method in class com.jme3.bullet.MultiBodyLink
Determine the index of this link in its MultiBody.
IndexBuffer - Class in jme3utilities.lbj
Wrapper class for the index buffer of a mesh.
IndexBuffer(int, int) - Constructor for class jme3utilities.lbj.IndexBuffer
Instantiate an IndexBuffer with a new direct, writable data buffer.
IndexBuffer(Buffer) - Constructor for class jme3utilities.lbj.IndexBuffer
Instantiate an IndexBuffer by wrapping the specified data buffer.
IndexedMesh - Class in com.jme3.bullet.collision.shapes.infos
An indexed triangle mesh based on Bullet's btIndexedMesh.
IndexedMesh(CollisionShape, int) - Constructor for class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Instantiate a IndexedMesh to visualize the specified collision shape.
IndexedMesh(Vector3f[], int[]) - Constructor for class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Instantiate an IndexedMesh based on the specified positions and indices.
IndexedMesh(FloatBuffer) - Constructor for class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Instantiate an IndexedMesh based on the specified vertex positions.
IndexedMesh(FloatBuffer, IntBuffer) - Constructor for class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Instantiate an IndexedMesh based on the specified positions and indices.
inertia(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the rotational inertia of this link.
influence() - Method in class com.jme3.bullet.joints.Anchor
Return how much influence the anchor has on the bodies.
initDefault() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Reinitialize the btSoftBody to the default values.
initSolverInfo() - Method in class com.jme3.bullet.PhysicsSpace
Initialize the solverInfo field during create().
initThread(long) - Method in class com.jme3.bullet.CollisionSpace
Must be invoked on the designated physics thread.
initUserPointer() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
(Re-)initialize the native user info of this collision object, which stores the collision group, collide-with groups, and spaceId (native field: m_userPointer).
inRange(double, String, double, double) - Static method in class jme3utilities.Validate
Validate a limited double-precision value as a method argument.
inRange(float, String, float, float) - Static method in class jme3utilities.Validate
Validate a limited single-precision value as a method argument.
inRange(int, String, int, int) - Static method in class jme3utilities.Validate
Validate a limited integer as a method argument.
Interleave - Static variable in class com.jme3.bullet.SolverMode
interleave contact and friction constraints
IntPair - Class in jme3utilities.math
Represent a pair of distinct integers.
IntPair(int, int) - Constructor for class jme3utilities.math.IntPair
Instantiate a pair.
inverse() - Method in class com.jme3.math.Quaternion
Returns the multiplicative inverse.
inverse() - Method in class com.simsilica.mathd.Quatd
Returns the multiplicative inverse.
invert() - Method in class com.jme3.math.Transform
Returns the inverse.
invert() - Method in class com.simsilica.mathd.Matrix3d
Returns the multiplicative inverse.
invert(Matrix3f) - Method in class com.jme3.math.Matrix3f
Returns the multiplicative inverse in the specified storage.
invertLocal() - Method in class com.jme3.math.Matrix4f
Inverts in place.
iOS - Enum constant in enum class com.jme3.system.Platform.Os
iOS operating systems
iOS_ARM - Enum constant in enum class com.jme3.system.Platform
iOS on ARM
iOS_X86 - Enum constant in enum class com.jme3.system.Platform
iOS on x86
is64Bit() - Method in enum class com.jme3.system.Platform
Test for a 64-bit address space.
isActive() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Test whether the collision object has been deactivated due to lack of motion.
isAllNonNegative(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Test whether all components of a vector are all non-negative: in other words, whether it's in the first octant or the boundaries thereof.
isAllowCollision() - Method in class com.jme3.bullet.joints.Anchor
Test whether collisions are allowed between the bodies.
isAllPositive(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Test whether all components of a vector are all positive: in other words, whether it's strictly inside the first octant.
isAngularOnly() - Method in class com.jme3.bullet.joints.ConeJoint
Test whether this joint is angular-only.
isAngularOnly() - Method in class com.jme3.bullet.joints.HingeJoint
Test whether this joint is angular-only, meaning no constraints on translation.
isApplyLocal() - Method in class com.jme3.bullet.objects.VehicleWheel
Test whether physics coordinates should match the local transform of the Spatial.
isApplyPhysicsLocal() - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Test whether physics-space coordinates should match the spatial's local coordinates.
isAsync() - Method in class vhacd4.Vhacd4Parameters
Test whether V-HACD should run on a new thread (native field: m_asyncACD).
isBetween(float, float, float) - Static method in class jme3utilities.math.MyMath
Test whether b is between a and c.
isCcdWithStaticOnly() - Method in class com.jme3.bullet.PhysicsSpace
Test whether CCD checks for collisions with static and kinematic bodies (native field: m_ccdWithStaticOnly).
isCollisionAllowed(long) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Test whether collisions are allowed between this body and the identified collision object.
isCollisionBetweenLinkedBodies() - Method in class com.jme3.bullet.joints.Constraint
Test whether collisions are handled between the ends.
isCollisionWithParent() - Method in class com.jme3.bullet.MultiBodyLink
Test whether collisions with the immediate parent link are enabled.
isCompressed() - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Test whether the hierarchy uses quantized AABB compression.
isConcave() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Test whether the shape has concave type.
isConcave() - Method in class com.jme3.bullet.collision.shapes.ConvexShape
Test whether this shape has concave type.
isContactCalcArea3Points() - Static method in class com.jme3.bullet.collision.ManifoldPoints
Determine how many points are used to calculate the area of the convex hull of a contact point.
isContactFilterEnabled() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Test whether contact filtering is enabled for this shape.
isContactResponse() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Test whether the collision object responds to contact with other objects.
isConvex() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Test whether the shape has convex type.
isConvex() - Method in class com.jme3.bullet.collision.shapes.ConvexShape
Test whether this shape has convex type.
isDampingLimited() - Method in class com.jme3.bullet.joints.motors.RotationMotor
Test whether the spring's damping is limited (native field: m_springDampingLimited).
isDampingLimited(int) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Test whether the indexed spring's damping is limited (m_springDampingLimited).
isDeactivationEnabled() - Static method in class com.jme3.bullet.objects.PhysicsBody
Test the global deactivation enable flag.
isDebug() - Static method in class com.jme3.bullet.util.NativeLibrary
Test whether the native library was built with debugging enabled.
isDirect() - Method in class jme3utilities.lbj.IndexBuffer
Test whether the buffer is direct.
isDoublePrecision() - Static method in class com.jme3.bullet.util.NativeLibrary
Test whether the native library uses double-precision arithmetic.
isDynamic() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Test whether the body is in dynamic mode.
isEmpty() - Method in class com.jme3.bullet.CollisionSpace
Test whether the space is empty.
isEmpty() - Method in class com.jme3.bullet.DeformableSpace
Test whether this space is empty.
isEmpty() - Method in class com.jme3.bullet.MultiBodySpace
Test whether this space is empty.
isEmpty() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Test whether this body is empty.
isEmpty() - Method in class com.jme3.bullet.PhysicsSoftSpace
Test whether this space is empty.
isEmpty() - Method in class com.jme3.bullet.PhysicsSpace
Test whether the space is empty.
isEnabled() - Method in class com.jme3.bullet.joints.Anchor
Test whether this Anchor is enabled.
isEnabled() - Method in class com.jme3.bullet.joints.Constraint
Test whether this Constraint is enabled.
isEnabled() - Method in class com.jme3.bullet.joints.PhysicsJoint
Test whether this joint is enabled.
isEnabled() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Test whether this joint is enabled.
isEnabled(int) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Test whether the indexed axis is enabled (native field: m_enableMotor).
isEnabled(DumpFlags) - Method in class jme3utilities.minie.PhysicsDumper
Test whether the specified dump flag is set.
isEnableMotor() - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Test whether this motor is enabled (native field: m_enableMotor).
isFeedback() - Method in class com.jme3.bullet.joints.Constraint
Test whether this Constraint has feedback enabled.
isFindBestPlane() - Method in class vhacd4.Vhacd4Parameters
Test whether V-HACD should try to find the optimal location for splitting hulls (native field: m_findBestPlane).
isFinite() - Method in class com.simsilica.mathd.Vec3d
Tests for finite components.
isFinite(float) - Static method in class jme3utilities.math.MyMath
Test whether the specified floating-point value is finite.
isFiniteDouble(double) - Static method in class jme3utilities.math.MyMath
Test whether the specified floating-point value is finite.
isForceUpdateAllAabbs() - Method in class com.jme3.bullet.CollisionSpace
Test whether the bounding boxes of inactive collision objects should be recomputed during each update() (native field: m_forceUpdateAllAabbs).
isFrontWheel() - Method in class com.jme3.bullet.objects.VehicleWheel
Test whether this wheel is a front (steering) wheel (native field: m_bIsFrontWheel).
isGravityProtected() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Test whether the body's gravity can be overwritten by PhysicsSpace.
isIdentity() - Method in class com.jme3.math.Matrix3f
Tests for exact identity.
isIdentity() - Method in class com.simsilica.mathd.Matrix3d
Tests for identity.
isIdentity(Transform) - Static method in class jme3utilities.math.MyMath
Test the specified transform for exact identity.
isInfinite() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Test whether the shape's type is infinite.
isInsideTriangle(Vector3f, float, Vector3f, Vector3f, Vector3f) - Static method in class com.jme3.bullet.util.NativeLibrary
Test whether the specified point and triangle are within the specified distance of each other.
isInWorld() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Test whether the collision object is added to a space.
isKinematic() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Test whether the body is in kinematic mode.
isLateralFrictionInitialized() - Method in class com.jme3.bullet.collision.PhysicsCollisionEvent
Test whether the contact point's lateral friction is initialized.
isLeafNode(int) - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Test whether the specified node is a leaf.
isMotorEnabled() - Method in class com.jme3.bullet.joints.motors.RotationMotor
Test whether the motor is enabled (native field: m_enableMotor).
isMotorEnabled(int) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Test whether the indexed motor is enabled (m_enableMotor).
isMotorEnabled(int) - Method in class com.jme3.bullet.joints.New6Dof
Test whether the motor is enabled for the indexed degree of freedom.
isNonMoving() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Test whether the shape can be applied to a dynamic rigid body.
isOdd(int) - Static method in class jme3utilities.math.MyMath
Test whether an integer value is odd.
isPolyhedral() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Test whether this shape is convex and defined by polygons.
isPoweredAngMotor() - Method in class com.jme3.bullet.joints.SliderJoint
Test whether the rotation motor is powered.
isPoweredLinMotor() - Method in class com.jme3.bullet.joints.SliderJoint
Test whether the translation motor is powered.
isPure(Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Test for a pure Quaternion.
isPureLines() - Method in interface jme3utilities.lbj.Mesh
Test whether the mesh consists of lines in list mode.
isPureTriangles() - Method in interface jme3utilities.lbj.Mesh
Test whether the mesh consists of triangles in list mode.
isQuickprof() - Static method in class com.jme3.bullet.util.NativeLibrary
Test whether the native library includes Quickprof profiling.
isReducedModesEnabled() - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Test whether reduced modes are enabled.
isRotationIdentity() - Method in class com.simsilica.mathd.Quatd
Tests for an identity rotation.
isRotationIdentity(Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Test whether the specified Quaternion represents an identity rotation.
isScaleIdentity(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Test for a scale identity.
isScaleUniform(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Test for a uniform scaling vector.
isServoEnabled() - Method in class com.jme3.bullet.joints.motors.RotationMotor
Test whether the servo is enabled (native field: m_servoMotor).
isServoEnabled(int) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Test whether the indexed servo is enabled (m_servoMotor).
isServoEnabled(int) - Method in class com.jme3.bullet.joints.New6Dof
Test whether the servo is enabled for the indexed degree of freedom.
isShrinkWrap() - Method in class vhacd4.Vhacd4Parameters
Test whether V-HACD should shrinkwrap voxel positions to the source mesh (native field: m_shrinkWrap).
isSoftRigid() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Test whether this joint is a soft-rigid joint.
isSoftSoft() - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Test whether this joint is a soft-soft joint.
isSplitImpulseEnabled() - Method in class com.jme3.bullet.SolverInfo
Test whether split impulse is enabled globally (native field: m_splitImpulse).
isSpringEnabled() - Method in class com.jme3.bullet.joints.motors.RotationMotor
Test whether the spring is enabled (native field: m_enableSpring).
isSpringEnabled(int) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Test whether the indexed spring is enabled (m_enableSpring).
isSpringEnabled(int) - Method in class com.jme3.bullet.joints.New6Dof
Test whether the spring is enabled for the indexed degree of freedom.
isSpringEnabled(int) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Test whether the spring for the indexed degree of freedom is enabled.
isStatic() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Test whether the collision object is static (immobile).
isStiffnessLimited() - Method in class com.jme3.bullet.joints.motors.RotationMotor
Test whether the spring's stiffness is limited (m_springStiffnessLimited).
isStiffnessLimited(int) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Test whether the indexed spring's stiffness is limited (m_springStiffnessLimited).
isThreadSafe() - Static method in class com.jme3.bullet.util.NativeLibrary
Test whether the native library was built thread-safe.
isUnitVector() - Method in class com.jme3.math.Vector3f
Tests for a unit vector, with 1% tolerance.
isUsingDeterministicDispatch() - Method in class com.jme3.bullet.CollisionSpace
Test whether the "deterministic overlapping pairs" option is enabled in the collision dispatcher (native field: m_deterministicOverlappingPairs).
isUsingGhostSweepTest() - Method in class com.jme3.bullet.objects.infos.CharacterController
Test whether the ghost's convex-sweep test is in use.
isUsingGhostSweepTest() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Test whether the ghost's convex-sweep test is in use.
isUsingGlobalVelocities() - Method in class com.jme3.bullet.MultiBody
Test whether this MultiBody uses global variables.
isUsingGyroTerm() - Method in class com.jme3.bullet.MultiBody
Test whether this MultiBody uses the gyro term.
isUsingRK4() - Method in class com.jme3.bullet.MultiBody
Test whether this MultiBody uses RK4 integration.
isUsingScr() - Method in class com.jme3.bullet.PhysicsSpace
Test whether the space uses Speculative Contact Restitution (native field: m_applySpeculativeContactRestitution).
isValidQuaternion(Quaternion) - Static method in class com.jme3.math.Quaternion
Tests whether the argument is a valid quaternion, returning false if it's null or if any component is NaN or infinite.
isValidVector(Vector3f) - Static method in class com.jme3.math.Vector3f
Tests whether the argument is a valid vector, returning false if it's null or if any component is NaN or infinite.
isWorldInfoProtected() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Test whether this body's world info should be replaced when added to a space.
isZero() - Method in class com.simsilica.mathd.Quatd
Tests for a zero value.
isZero(Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Test for a zero Quaternion.
isZero(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Test for a zero vector or translation identity.

J

jme3utilities - package jme3utilities
Miscellaneous reusable classes for use with jMonkeyEngine3.
jme3utilities.debug - package jme3utilities.debug
Reusable classes for testing and debugging applications based on jMonkeyEngine3.
jme3utilities.lbj - package jme3utilities.lbj
Generic objects for visualizing soft bodies.
jme3utilities.math - package jme3utilities.math
Reusable classes which implement mathematical formulas and operations, for use with jMonkeyEngine3.
jme3utilities.math.noise - package jme3utilities.math.noise
Reusable classes and interfaces for implementing noise and pseudo-random number generation in jMonkeyEngine3.
jme3utilities.minie - package jme3utilities.minie
Bullet physics support for jMonkeyEngine3.
JmeSystem - Class in com.jme3.system
Utility class to access platform-dependent features.
jniEnvId() - Method in class com.jme3.bullet.CollisionSpace
Return the address of the JNIEnv that the space uses for callbacks.
jniEnvId() - Static method in class com.jme3.bullet.util.NativeLibrary
Return the address of the current thread's JNIEnv.
JointEnd - Enum Class in com.jme3.bullet.joints
Enumerate the ends of a physics joint.
jointErp() - Method in class com.jme3.bullet.SolverInfo
Return the error-reduction parameter for non-contact constraints (native field: m_erp).
jointPosition(int) - Method in class com.jme3.bullet.MultiBodyLink
Determine the position of the indexed DOF.
JointsInBodies - Enum constant in enum class jme3utilities.minie.DumpFlags
physics joints in rigid bodies
JointsInSpaces - Enum constant in enum class jme3utilities.minie.DumpFlags
joints in physics spaces
jointTorque(int) - Method in class com.jme3.bullet.MultiBodyLink
Determine the torque applied to the indexed DOF using MultiBodyLink.addJointTorque(int, float), which is zeroed after each simulation step.
jointType() - Method in class com.jme3.bullet.MultiBodyLink
Determine the type of joint between this link and its parent.
jointVelocity(int) - Method in class com.jme3.bullet.MultiBodyLink
Determine the velocity of the indexed DOF.
jump() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Jump in the "up" direction.
jump(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Jump in the specified direction.
jump(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Jump in the specified direction.

K

KeepUnflippedNormal - Static variable in class com.jme3.bullet.RayTestFlag
when a ray hits a back-facing triangle, don't reverse the face normal (native value: kF_KeepUnflippedNormal)
KINEMATIC_OBJECT - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag for a kinematic object
kineticEnergy() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Calculate the body's kinetic energy (linear + angular).
KineticHardness - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
contact hardness coefficient for static or kinematic rigid bodies (≥0, ≤1, default=0.1, native field: kKHR)

L

larger() - Method in class jme3utilities.math.IntPair
Read the larger element of the pair.
lastAxis - Static variable in class jme3utilities.math.MyVector3f
index of the final (Z) axis
lastValue - Static variable in class com.jme3.bullet.collision.Activation
highest legal value, for range checks
LATERAL_FRICTION - Static variable in class com.jme3.bullet.collision.ContactPointFlag
lateral friction is initialized
Lemke - Enum constant in enum class com.jme3.bullet.SolverType
btLemkeSolver: accurate-but-slow MLCP direct solver using Lemke’s Algorithm (see "Fast Implementation of Lemke’s Algorithm for Rigid Body Contact Simulation" by John E.
length() - Method in class com.jme3.math.Vector3f
Returns the length (or magnitude).
length() - Method in class com.simsilica.mathd.Vec3d
Returns the length (or magnitude).
lengthSq() - Method in class com.simsilica.mathd.Quatd
Returns the squared length.
lengthSq() - Method in class com.simsilica.mathd.Vec3d
Returns the square of the length.
lengthSquared() - Method in class com.jme3.math.Vector3f
Returns the square of the length.
lengthSquared(Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Return the squared length of the argument.
lengthSquared(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Determine the squared length of a vector.
lerp(float, float, float) - Static method in class jme3utilities.math.MyMath
Interpolate linearly between (or extrapolate linearly from) 2 single-precision values.
lerp(float, Vector3f, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVector3f
Interpolate linearly between (or extrapolate linearly from) 2 vectors.
Lift - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
lift coefficient (≥0, default=0, native field: kLF)
limit(int) - Method in class jme3utilities.lbj.IndexBuffer
Alter the limit.
linearDamping() - Method in class com.jme3.bullet.MultiBody
Determine the linear damping.
LinearDamping - Enum constant in enum class com.jme3.bullet.objects.infos.Cluster
linear damping coefficient (default=0, native field: m_ldamping)
linearStiffness() - Method in class com.jme3.bullet.objects.infos.SoftBodyMaterial
Read the linear-stiffness coefficient (native field: m_kLST).
linkIndex() - Method in class com.jme3.bullet.objects.MultiBodyCollider
Determine the index of the corresponding MultiBodyLink.
Linux - Enum constant in enum class com.jme3.system.Platform.Os
Linux operating systems
Linux_ARM32 - Enum constant in enum class com.jme3.system.Platform
Linux 32-bit ARM
Linux_ARM64 - Enum constant in enum class com.jme3.system.Platform
Linux 64-bit ARM
Linux32 - Enum constant in enum class com.jme3.system.Platform
Linux 32-bit Intel
Linux64 - Enum constant in enum class com.jme3.system.Platform
Linux 64-bit Intel
listChildren() - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Enumerate the child shapes.
listColliders() - Method in class com.jme3.bullet.MultiBody
Enumerate the colliders in this MultiBody.
listIgnoredPcos() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Enumerate all collision objects in this object's ignore list.
listJoints() - Method in class com.jme3.bullet.objects.PhysicsBody
Enumerate the joints connected to this body.
listManifoldIds() - Method in class com.jme3.bullet.PhysicsSpace
Enumerate the native IDs of all collision manifolds in the space.
listNodesInCluster(int, IntBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
List all nodes in the indexed cluster.
listPointIds(long) - Static method in class com.jme3.bullet.collision.PersistentManifolds
Enumerate the native IDs of all points in the specified manifold.
listSeparator() - Method in class jme3utilities.debug.Describer
Return the list separator.
loadIdentity() - Method in class com.jme3.math.Matrix3f
Configures as an identity matrix (diagonals = 1, other elements = 0).
loadIdentity() - Method in class com.jme3.math.Matrix4f
Configures as an identity matrix (diagonals = 1, other elements = 0).
loadIdentity() - Method in class com.jme3.math.Quaternion
Sets all components to zero except w, which is set to 1.
loadIdentity() - Method in class com.jme3.math.Transform
Sets the current instance to the identity transform: translation=(0,0,0) scaling=(1,1,1) rotation=(0,0,0,1).
loadIdentity() - Method in class com.jme3.math.TransformDp
Sets the current instance to the identity transform: translation=(0,0,0) scaling=(1,1,1) rotation=(0,0,0,1).
loadLibbulletjme(boolean, File, String, String) - Static method in class com.jme3.system.NativeLibraryLoader
Load a Libbulletjme native library.
localToWorld(Vector3f, Vector3f) - Method in class jme3utilities.math.RectangularSolid
Rotate from local coordinates to world coordinates.
locateSupport(float, float, float) - Method in class com.jme3.bullet.collision.shapes.CustomConvexShape
Locate the shape's supporting vertex for the specified normal direction, excluding collision margin.
location(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the location of this link's center of mass.
log(Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Return the natural logarithm of a normalized quaternion.
log2(int) - Static method in class jme3utilities.math.MyMath
Calculate the floor of the base-2 logarithm of the input value.
logger - Static variable in class com.jme3.bullet.collision.Activation
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.AfMode
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.CollisionFlag
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.ContactPointFlag
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.ManifoldPoints
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.PcoType
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.PersistentManifolds
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.PhysicsCollisionEvent
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.PhysicsCollisionObject
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.PhysicsRayTestResult
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.PhysicsSweepTestResult
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.shapes.CollisionShape
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
message logger for this class
logger - Static variable in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
message logger for this class
logger - Static variable in class com.jme3.bullet.CollisionConfiguration
message logger for this class
logger - Static variable in class com.jme3.bullet.joints.motors.RotationalLimitMotor
message logger for this class
logger - Static variable in class com.jme3.bullet.joints.motors.RotationMotor
message logger for this class
logger - Static variable in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
message logger for this class
logger - Static variable in class com.jme3.bullet.joints.motors.TranslationMotor
message logger for this class
logger - Static variable in class com.jme3.bullet.joints.PhysicsJoint
message logger for this class
logger - Static variable in class com.jme3.bullet.MultiBody
message logger for this class
logger - Static variable in class com.jme3.bullet.MultiBodyLink
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.infos.CharacterController
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.infos.RigidBodyMotionState
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.infos.RigidBodySnapshot
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.infos.SoftBodyConfig
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.infos.SoftBodyMaterial
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.infos.VehicleController
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.infos.VehicleTuning
message logger for this class
logger - Static variable in class com.jme3.bullet.objects.VehicleWheel
message logger for this class
logger - Static variable in class com.jme3.bullet.PhysicsSpace
message logger for this class
logger - Static variable in class com.jme3.bullet.RayTestFlag
message logger for this class
logger - Static variable in class com.jme3.bullet.SoftBodyWorldInfo
message logger for this class
logger - Static variable in class com.jme3.bullet.SolverInfo
message logger for this class
logger - Static variable in class com.jme3.bullet.SolverMode
message logger for this class
logger - Static variable in class com.jme3.bullet.util.DebugShapeFactory
message logger for this class
logger - Static variable in class com.jme3.bullet.util.NativeLibrary
message logger for this class
logger - Static variable in class com.jme3.bullet.util.NativeSoftBodyUtil
message logger for this class
logger - Static variable in class com.jme3.math.TransformDp
message logger for this class
logger - Static variable in class com.jme3.system.NativeLibraryLoader
message logger for this class
logger - Static variable in class jme3utilities.math.IntPair
message logger for this class
logger - Static variable in class jme3utilities.math.MyBuffer
message logger for this class
logger - Static variable in class jme3utilities.math.MyMath
message logger for this class
logger - Static variable in class jme3utilities.math.MyQuaternion
message logger for this class
logger - Static variable in class jme3utilities.math.MyVector3f
message logger for this class
logger - Static variable in class jme3utilities.math.MyVolume
message logger for this class
logger - Static variable in class jme3utilities.math.RectangularSolid
message logger for this class
logger - Static variable in class jme3utilities.math.VectorSetUsingBuffer
message logger for this class
logger - Static variable in class jme3utilities.minie.MyPco
message logger for this class
logger - Static variable in class jme3utilities.minie.MyShape
message logger for this class
logger - Static variable in class jme3utilities.minie.PhysicsDescriber
message logger for this class
logger - Static variable in class jme3utilities.minie.PhysicsDumper
message logger for this class
logger - Static variable in class jme3utilities.Validate
message logger for this class
logger - Static variable in class vhacd.VHACD
message logger for this class
logger - Static variable in class vhacd.VHACDHull
message logger for this class
logger - Static variable in class vhacd.VHACDParameters
message logger for this class
logger - Static variable in class vhacd4.Vhacd4
message logger for this class
logger - Static variable in class vhacd4.Vhacd4Hull
message logger for this class
logger - Static variable in class vhacd4.Vhacd4Parameters
message logger for this class
logger15 - Static variable in class com.jme3.bullet.joints.Constraint
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.Box2dShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.BoxCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.ConeCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.ConicalFrustum
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.Convex2dShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.CylinderCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.EmptyShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.HullCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.MeshCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.MinkowskiSum
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.MultiSphere
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.PlaneCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.SphereCollisionShape
message logger for this class
logger2 - Static variable in class com.jme3.bullet.collision.shapes.SphericalSegment
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.Anchor
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.ConeJoint
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.GearJoint
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.HingeJoint
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.New6Dof
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.Point2PointJoint
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.SixDofJoint
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.SliderJoint
message logger for this class
logger2 - Static variable in class com.jme3.bullet.joints.SoftPhysicsJoint
message logger for this class
logger2 - Static variable in class com.jme3.bullet.MultiBodySpace
message logger for this class
logger2 - Static variable in class com.jme3.bullet.objects.MultiBodyCollider
message logger for this class
logger2 - Static variable in class com.jme3.bullet.objects.PhysicsCharacter
message logger for this class
logger2 - Static variable in class com.jme3.bullet.objects.PhysicsGhostObject
message logger for this class
logger2 - Static variable in class com.jme3.bullet.objects.PhysicsRigidBody
message logger for this class
logger2 - Static variable in class com.jme3.bullet.objects.PhysicsSoftBody
message logger for this class
logger2 - Static variable in class com.jme3.bullet.PhysicsSoftSpace
message logger for this class
logger3 - Static variable in class com.jme3.bullet.DeformableSpace
message logger for this class
logger3 - Static variable in class com.jme3.bullet.joints.NewHinge
message logger for this class
logger3 - Static variable in class com.jme3.bullet.joints.SixDofSpringJoint
message logger for this class
logger3 - Static variable in class com.jme3.bullet.joints.SoftAngularJoint
message logger for this class
logger3 - Static variable in class com.jme3.bullet.joints.SoftLinearJoint
message logger for this class
logger3 - Static variable in class com.jme3.bullet.objects.PhysicsVehicle
message logger for this class
logger3 - Static variable in class com.jme3.bullet.objects.ReducedDeformableBody
message logger for this class
loggerC - Static variable in class com.jme3.bullet.CollisionSpace
message logger for this class
loggerN - Static variable in class com.jme3.bullet.NativePhysicsObject
message logger for this class
loggerX - Static variable in class com.jme3.bullet.collision.shapes.ConvexShape
message logger for this class
loggerY - Static variable in class com.jme3.bullet.collision.shapes.CustomConvexShape
message logger for this class
LowerLimit - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
constraint lower limit (m_loLimit/m_lowerLimit, default=1[rot] or 0[translate])
lowResolution - Static variable in class com.jme3.bullet.util.DebugShapeFactory
specify low-res debug meshes for convex shapes (up to 42 vertices) and zero-margin debug meshes for concave shapes

M

m00 - Variable in class com.jme3.math.Matrix3f
The element in row 0, column 0.
m00 - Variable in class com.jme3.math.Matrix4f
The element in row 0, column 0.
m00 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 0, column 0.
m01 - Variable in class com.jme3.math.Matrix3f
The element in row 0, column 1.
m01 - Variable in class com.jme3.math.Matrix4f
The element in row 0, column 1.
m01 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 0, column 1.
m02 - Variable in class com.jme3.math.Matrix3f
The element in row 0, column 2.
m02 - Variable in class com.jme3.math.Matrix4f
The element in row 0, column 2.
m02 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 0, column 2.
m03 - Variable in class com.jme3.math.Matrix4f
The element in row 0, column 3 (the X translation).
m10 - Variable in class com.jme3.math.Matrix3f
The element in row 1, column 0.
m10 - Variable in class com.jme3.math.Matrix4f
The element in row 1, column 0.
m10 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 1, column 0.
m11 - Variable in class com.jme3.math.Matrix3f
The element in row 1, column 1.
m11 - Variable in class com.jme3.math.Matrix4f
The element in row 1, column 1.
m11 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 1, column 1.
m12 - Variable in class com.jme3.math.Matrix3f
The element in row 1, column 2.
m12 - Variable in class com.jme3.math.Matrix4f
The element in row 1, column 2.
m12 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 1, column 2.
m13 - Variable in class com.jme3.math.Matrix4f
The element in row 1, column 3 (the Y translation).
m20 - Variable in class com.jme3.math.Matrix3f
The element in row 2, column 0.
m20 - Variable in class com.jme3.math.Matrix4f
The element in row 2, column 0.
m20 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 2, column 0.
m21 - Variable in class com.jme3.math.Matrix3f
The element in row 2, column 1.
m21 - Variable in class com.jme3.math.Matrix4f
The element in row 2, column 1.
m21 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 2, column 1.
m22 - Variable in class com.jme3.math.Matrix3f
The element in row 2, column 2.
m22 - Variable in class com.jme3.math.Matrix4f
The element in row 2, column 2.
m22 - Variable in class com.simsilica.mathd.Matrix3d
The element in row 2, column 2.
m23 - Variable in class com.jme3.math.Matrix4f
The element in row 2, column 3 (the Z translation).
m30 - Variable in class com.jme3.math.Matrix4f
The element in row 3, column 0.
m31 - Variable in class com.jme3.math.Matrix4f
The element in row 3, column 1.
m32 - Variable in class com.jme3.math.Matrix4f
The element in row 3, column 2.
m33 - Variable in class com.jme3.math.Matrix4f
The element in row 3, column 3.
MacOS - Enum constant in enum class com.jme3.system.Platform.Os
macOS operating systems
MacOSX_ARM64 - Enum constant in enum class com.jme3.system.Platform
Apple Mac OS X 64-bit ARM
MacOSX_PPC32 - Enum constant in enum class com.jme3.system.Platform
Apple Mac OS X 32 bit PowerPC
MacOSX_PPC64 - Enum constant in enum class com.jme3.system.Platform
Apple Mac OS X 64 bit PowerPC
MacOSX32 - Enum constant in enum class com.jme3.system.Platform
Apple Mac OS X 32-bit Intel
MacOSX64 - Enum constant in enum class com.jme3.system.Platform
Apple Mac OS X 64-bit Intel
main(String[]) - Static method in class jme3utilities.minie.TestApp
Main entry point for the TestApp application.
makeIdentity() - Method in class com.simsilica.mathd.Matrix3d
Configures the matrix as an identity matrix (diagonals = 1, other elements = 0).
makeImmutable() - Method in class jme3utilities.lbj.IndexBuffer
Make the buffer immutable.
ManifoldPoints - Class in com.jme3.bullet.collision
Utility class to access fields of Bullet's btManifoldPoint class.
mapIndices(IntBuffer, IndexBuffer, IndexBuffer) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Map all indices in the specified input buffer using the specified map buffer.
mapVertexData(IntBuffer, FloatBuffer, int) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Copy all vertex data in the specified input buffer, using the specified map buffer to map vertex indices.
margin - Variable in class com.jme3.bullet.collision.shapes.CollisionShape
copy of collision margin (in physics-space units, >0, default=0.04)
margin() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Read the collision margin of this body.
mass - Variable in class com.jme3.bullet.objects.PhysicsRigidBody
JVM copy of the mass (>0) of a dynamic body, or 0 for a static body
mass() - Method in class com.jme3.bullet.MultiBodyLink
Determine the mass of this link.
mass() - Method in class com.jme3.bullet.objects.MultiBodyCollider
Determine the mass of this collider.
massForStatic - Static variable in class com.jme3.bullet.objects.PhysicsBody
magic mass value used to specify a static rigid body or soft-body node
Matching - Enum constant in enum class com.jme3.bullet.objects.infos.Cluster
matching coefficient (default=0, native field: m_matching)
Matrix3d - Class in com.simsilica.mathd
A square matrix composed of 9 double-precision elements, used to represent linear transformations of 3-dimensional vectors.
Matrix3d() - Constructor for class com.simsilica.mathd.Matrix3d
Instantiates an identity matrix (diagonals = 1, other elements = 0).
Matrix3d(double, double, double, double, double, double, double, double, double) - Constructor for class com.simsilica.mathd.Matrix3d
Instantiates a matrix with the specified elements.
Matrix3f - Class in com.jme3.math
A 3x3 matrix composed of 9 single-precision elements, used to represent linear transformations of 3-D coordinates, such as rotations, reflections, and scaling.
Matrix3f() - Constructor for class com.jme3.math.Matrix3f
Instantiates an identity matrix (diagonals = 1, other elements = 0).
Matrix3f(float, float, float, float, float, float, float, float, float) - Constructor for class com.jme3.math.Matrix3f
Instantiates a matrix with specified elements.
Matrix4f - Class in com.jme3.math
A 4x4 matrix composed of 16 single-precision elements, used to represent linear or perspective transformations of 3-D coordinates.
Matrix4f() - Constructor for class com.jme3.math.Matrix4f
Instantiates an identity matrix (diagonals = 1, other elements = 0).
matrixToEuler(Matrix3f, Vector3f) - Method in enum class com.jme3.bullet.RotationOrder
Convert a rotation matrix to Euler angles for this RotationOrder.
max(float...) - Static method in class jme3utilities.math.MyMath
Find the maximum of some single-precision values.
maxAbs(Vector3f) - Method in interface jme3utilities.math.VectorSet
Find the maximum absolute coordinate for each axis among the Vector3f values in this set.
maxAbs(Vector3f) - Method in class jme3utilities.math.VectorSetUsingBuffer
Find the maximum absolute coordinate for each axis among the Vector3f values in this set.
maxAbs(FloatBuffer, int, int, Vector3f) - Static method in class jme3utilities.math.MyBuffer
Find the maximum absolute coordinate for each axis in the specified FloatBuffer range.
maxAppliedImpulse() - Method in class com.jme3.bullet.MultiBody
Determine the maximum applied impulse.
maxCoordinateVelocity() - Method in class com.jme3.bullet.MultiBody
Determine the maximum coordinate velocity.
maxDisplacement() - Method in class com.jme3.bullet.SoftBodyWorldInfo
Return the maximum distance a node can travel in a simulation step.
maxDistance(CollisionShape, Transform, int) - Static method in class com.jme3.bullet.util.DebugShapeFactory
Estimate how far the specified (non-compound, non-plane) shape extends from some origin, based on its debug mesh.
maxDistance(Transform) - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Calculate how far the mesh extends from some origin.
maxima(Vector3f) - Method in class jme3utilities.math.RectangularSolid
Copy the maximum coordinate value for each local axis.
maxInt(int...) - Static method in class jme3utilities.math.MyMath
Find the maximum of some int values.
maxLength() - Method in interface jme3utilities.math.VectorSet
Find the magnitude of the longest vector in this set.
maxLength() - Method in class jme3utilities.math.VectorSetUsingBuffer
Find the magnitude of the longest vector in this set.
maxLength(FloatBuffer, int, int) - Static method in class jme3utilities.math.MyBuffer
Find the magnitude of the longest 3-D vector in the specified FloatBuffer range.
maxManifolds() - Method in class com.jme3.bullet.CollisionConfiguration
Return the size of the persistent-manifold pool.
maxMin(Vector3f, Vector3f) - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Find the maximum and minimum coordinates for each local axis among the scaled vertices in this mesh.
maxMin(Vector3f, Vector3f) - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Find the maximum and minimum coordinates for each axis among the vertices in this mesh.
maxMin(Vector3f, Vector3f) - Method in interface jme3utilities.math.VectorSet
Find the maximum and minimum coordinates for each axis among the values in this set.
maxMin(Vector3f, Vector3f) - Method in class jme3utilities.math.VectorSetUsingBuffer
Find the maximum and minimum coordinates for each axis among the values in this set.
maxMin(FloatBuffer, int, int, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyBuffer
Find the maximum and minimum coordinates of 3-D vectors in the specified FloatBuffer range.
MaxMotorForce - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
maximum motor force (m_maxMotorForce, default=6[rot] or 0[translate])
maxRadius() - Method in class com.jme3.bullet.collision.shapes.Box2dShape
Calculate how far the scaled shape extends from its center.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.BoxCollisionShape
Calculate how far the scaled shape extends from its center.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Calculate how far the scaled shape extends from its center.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Estimate how far the scaled shape extends from its center, including margin.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Estimate how far the shape extends from its origin.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.ConeCollisionShape
Calculate how far the scaled shape extends from its center of mass, including collision margin.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.ConicalFrustum
Calculate how far the scaled shape extends from its center of mass, including collision margin.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Calculate how far the scaled shape extends from its center.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.EmptyShape
Calculate how far the shape extends from its center.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Calculate how far this shape extends from its center, including margin.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.PlaneCollisionShape
Calculate how far the shape extends.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Calculate how far the shape extends from its origin, including margin.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.SphereCollisionShape
Calculate how far the scaled shape extends from its center.
maxRadius() - Method in class com.jme3.bullet.collision.shapes.SphericalSegment
Calculate how far the scaled shape extends from its center of mass, including collision margin.
MaxSelfImpulse - Enum constant in enum class com.jme3.bullet.objects.infos.Cluster
maximum self-collision impulse (default=100, native field: m_maxSelfCollisionImpulse)
maxSubmeshes - Static variable in class com.jme3.bullet.collision.shapes.MeshCollisionShape
maximum number of submeshes when compression is used
maxSubSteps() - Method in class com.jme3.bullet.PhysicsSpace
Return the maximum number of simulation steps per frame.
maxTimeStep() - Method in class com.jme3.bullet.PhysicsSpace
Return the maximum time step (imposed when maxSubSteps=0).
maxTrianglesInAnySubmesh - Static variable in class com.jme3.bullet.collision.shapes.MeshCollisionShape
maximum number of triangles in any submesh when compression is used
maxValue() - Method in enum class com.jme3.bullet.joints.motors.MotorParam
Determine the maximum value for this parameter.
maxValue() - Method in enum class com.jme3.bullet.objects.infos.Cluster
Determine the maximum value for this parameter.
maxValue() - Method in enum class com.jme3.bullet.objects.infos.Sbcp
Determine the maximum value for this parameter.
MaxVolumeRatio - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
maximum volume ratio for the pose (default=1, native field: maxvolume)
mean(Vector3f) - Method in interface jme3utilities.math.VectorSet
Determine the sample mean for each axis among the values in this set.
mean(Vector3f) - Method in class jme3utilities.math.VectorSetUsingBuffer
Determine the sample mean for each axis among the values in this set.
mean(FloatBuffer, int, int, Vector3f) - Static method in class jme3utilities.math.MyBuffer
Determine the arithmetic mean of 3-D vectors in the specified FloatBuffer range.
mechanicalEnergy() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Calculate the mechanical energy of the body (kinetic + potential) assuming a uniform gravitational field.
Mesh - Interface in jme3utilities.lbj
A generic mesh for visualizing a soft body.
MeshCollisionShape - Class in com.jme3.bullet.collision.shapes
A mesh collision shape that uses a Bounding Value Hierarchy (BVH), based on Bullet's btBvhTriangleMeshShape.
MeshCollisionShape(boolean, CompoundMesh) - Constructor for class com.jme3.bullet.collision.shapes.MeshCollisionShape
Instantiate a shape based on the specified CompoundMesh.
MeshCollisionShape(boolean, IndexedMesh...) - Constructor for class com.jme3.bullet.collision.shapes.MeshCollisionShape
Instantiate a shape from the specified native mesh(es).
MeshCollisionShape(boolean, Collection<IndexedMesh>) - Constructor for class com.jme3.bullet.collision.shapes.MeshCollisionShape
Instantiate a shape from the specified collection of native meshes.
MeshCollisionShape(byte[], IndexedMesh...) - Constructor for class com.jme3.bullet.collision.shapes.MeshCollisionShape
Instantiate a shape from the specified native mesh(es) and serialized BVH.
mid(float, float, float) - Static method in class jme3utilities.math.MyMath
Find the median of 3 single-precision values.
midpoint(Vector3f, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVector3f
Determine the midpoint between 2 locations.
min(float...) - Static method in class jme3utilities.math.MyMath
Find the minimum of some single-precision values.
minBatch() - Method in class com.jme3.bullet.SolverInfo
Determine the minimum batch size (native field: m_minimumSolverBatchSize).
minima(Vector3f) - Method in class jme3utilities.math.RectangularSolid
Copy minimum coordinate value for each local axis.
MinkowskiSum - Class in com.jme3.bullet.collision.shapes
A convex collision shape to represent the Minkowki sum of 2 convex shapes, based on Bullet's btMinkowskiSumShape.
MinkowskiSum(ConvexShape, ConvexShape) - Constructor for class com.jme3.bullet.collision.shapes.MinkowskiSum
Instantiate the Minkowki sum of the specified shapes.
minValue() - Method in enum class com.jme3.bullet.joints.motors.MotorParam
Determine the minimum value for this parameter.
minValue() - Method in enum class com.jme3.bullet.objects.infos.Cluster
Determine the minimum value for this parameter.
minValue() - Method in enum class com.jme3.bullet.objects.infos.Sbcp
Determine the minimum value for this parameter.
mode() - Method in class com.jme3.bullet.SolverInfo
Determine the mode flags (native field: m_solverMode).
modulo(float, float) - Static method in class jme3utilities.math.MyMath
Return the least non-negative value congruent with the input value with respect to the specified modulus.
modulo(int, int) - Static method in class jme3utilities.math.MyMath
Return the least non-negative value congruent with the input value with respect to the specified modulus.
MotorCfm - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
constraint-force mixing parameter between limits (m_motorCFM, native name: BT_CONSTRAINT_CFM, default=0)
MotorErp - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
error-reduction parameter between limits (m_motorERP, native name: BT_CONSTRAINT_ERP, default=0.9)
MotorParam - Enum Class in com.jme3.bullet.joints.motors
Enumerate certain parameters of a RotationMotor or TranslationMotor, based on Bullet's btConstraintParams.
Motors - Enum constant in enum class jme3utilities.minie.DumpFlags
motors in physics joints
mult(float) - Method in class com.jme3.math.Vector3f
Multiplies with the argument and returns the product as a new instance.
mult(float, float, float) - Method in class com.jme3.math.Vector3f
Multiplies component-wise by the specified components and returns the product as a new instance.
mult(float, Vector3f) - Method in class com.jme3.math.Vector3f
Multiplies with the specified scalar and returns the product in the specified vector.
mult(Matrix3f, Matrix3f) - Method in class com.jme3.math.Matrix3f
Multiplies with the specified matrix and returns the product in a 3rd matrix.
mult(Quaternion) - Method in class com.jme3.math.Quaternion
Multiplies by the argument and returns the product as a new instance.
mult(Quaternion, Quaternion) - Method in class com.jme3.math.Quaternion
Multiplies by the specified quaternion and returns the product in a 3rd quaternion.
mult(Vector3f) - Method in class com.jme3.math.Vector3f
Multiplies component-wise with the argument and returns the product as a new instance.
mult(Vector3f, Vector3f) - Method in class com.jme3.math.Matrix3f
Applies the linear transformation to specified vector and stores the result in another vector.
mult(Vector3f, Vector3f) - Method in class com.jme3.math.Vector3f
Multiplies component-wise with the specified vector and returns the product in a 3rd vector.
mult(Quatd) - Method in class com.simsilica.mathd.Quatd
Takes the Hamilton product of the current instance times the argument to yield a new Quatd.
mult(Quatd, Quatd) - Method in class com.simsilica.mathd.Quatd
Takes the Hamilton product of the current instance times the first argument and returns the product in the 2nd argument.
mult(Vec3d) - Method in class com.simsilica.mathd.Quatd
Rotates the argument vector to produce a new vector.
mult(Vec3d, Vec3d) - Method in class com.simsilica.mathd.Quatd
Rotates a specified vector and return the result in another vector.
MultiBody - Class in com.jme3.bullet
An articulated rigid body based on Bullet's btMultiBody.
MultiBody(int, float, Vector3f, boolean, boolean) - Constructor for class com.jme3.bullet.MultiBody
Instantiate a MultiBody.
MultiBodyCollider - Class in com.jme3.bullet.objects
A collision object for a link or base in a MultiBody, based on Bullet's btMultiBodyLinkCollider.
MultiBodyCollider(MultiBody, int) - Constructor for class com.jme3.bullet.objects.MultiBodyCollider
Instantiate a collider for the indexed link in the specified MultiBody.
MultiBodyJointType - Enum Class in com.jme3.bullet
Enumerate the types of joints in a MultiBody (native name: eFeatherstoneJointType).
MultiBodyLink - Class in com.jme3.bullet
A single link in a MultiBody, based on Bullet's btMultibodyLink.
MultiBodySpace - Class in com.jme3.bullet
A PhysicsSpace that supports multibodies, with its own btMultiBodyDynamicsWorld.
MultiBodySpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType) - Constructor for class com.jme3.bullet.MultiBodySpace
Instantiate a MultiBodySpace with a sequential-impulse solver.
MultiBodySpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, SolverType) - Constructor for class com.jme3.bullet.MultiBodySpace
Instantiate a MultiBodySpace with the specified contact-and-constraint solver.
MultiSphere - Class in com.jme3.bullet.collision.shapes
A convex collision shape based on Bullet's btMultiSphereShape.
MultiSphere(float) - Constructor for class com.jme3.bullet.collision.shapes.MultiSphere
Instantiate a centered sphere shape with the specified radius.
MultiSphere(float, float) - Constructor for class com.jme3.bullet.collision.shapes.MultiSphere
Instantiate a centered Y-axis capsule shape with the specified radius and height.
MultiSphere(float, float, int) - Constructor for class com.jme3.bullet.collision.shapes.MultiSphere
Instantiate a centered capsule shape with the specified radius, height, and axis.
MultiSphere(Vector3f[], float...) - Constructor for class com.jme3.bullet.collision.shapes.MultiSphere
Instantiate a multi-sphere shape with the specified centers and radii.
MultiSphere(Vector3f, float) - Constructor for class com.jme3.bullet.collision.shapes.MultiSphere
Instantiate an eccentric sphere shape with the specified center and radius.
MultiSphere(List<Vector3f>, List<Float>) - Constructor for class com.jme3.bullet.collision.shapes.MultiSphere
Instantiate a multi-sphere shape with the specified centers and radii.
MultiSphere(RectangularSolid) - Constructor for class com.jme3.bullet.collision.shapes.MultiSphere
Instantiate a 4-sphere shape to fill the specified RectangularSolid.
multLocal(double) - Method in class com.simsilica.mathd.Matrix3d
Multiplies by the scalar argument and returns the (modified) current instance.
multLocal(double) - Method in class com.simsilica.mathd.Vec3d
Multiplies by the scalar argument and returns the (modified) current instance.
multLocal(float) - Method in class com.jme3.math.Matrix3f
Multiplies by the scalar argument and returns the (modified) current instance.
multLocal(float) - Method in class com.jme3.math.Matrix4f
Multiplies in place by the scalar argument.
multLocal(float) - Method in class com.jme3.math.Quaternion
Multiplies by the scalar argument and returns the (modified) current instance.
multLocal(float) - Method in class com.jme3.math.Vector3f
Multiplies by the argument and returns the (modified) current instance.
multLocal(float, float, float) - Method in class com.jme3.math.Vector3f
Multiplies component-wise by the specified components and returns the (modified) current instance.
multLocal(float, float, float, float) - Method in class com.jme3.math.Quaternion
Multiplies by a quaternion with the specified components and returns the (modified) current instance.
multLocal(Quaternion) - Method in class com.jme3.math.Quaternion
Multiplies by the argument and returns the (modified) current instance.
multLocal(Vector3f) - Method in class com.jme3.math.Vector3f
Multiplies component-wise by the argument and returns the (modified) current instance.
multLocal(Quatd) - Method in class com.simsilica.mathd.Quatd
Takes the Hamilton product of the current instance times the argument, in place.
multLocal(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Multiplies component-wise by the argument and returns the (modified) current instance.
MyBuffer - Class in jme3utilities.math
Utility methods that operate on buffers, especially float buffers containing 3-D vectors.
MyMath - Class in jme3utilities.math
Mathematical utility methods.
MyPco - Class in jme3utilities.minie
Utility methods that operate on physics collision objects.
MyQuaternion - Class in jme3utilities.math
Mathematical utility methods.
MyShape - Class in jme3utilities.minie
Utility methods for physics collision shapes.
MyString - Class in jme3utilities
Utility methods for char sequences, strings, and collections of strings.
MyVector3f - Class in jme3utilities.math
Utility methods for 3-D vectors.
MyVolume - Class in jme3utilities.math
Utility methods for computing volumes of shapes.

N

nativeId() - Method in class com.jme3.bullet.NativePhysicsObject
Return the ID of the assigned native object, assuming that one is assigned.
NativeIDs - Enum constant in enum class jme3utilities.minie.DumpFlags
native IDs of physics objects
nativeIndex() - Method in enum class com.jme3.bullet.joints.motors.MotorParam
Determine the parameter's index in native code.
NativeLibrary - Class in com.jme3.bullet.util
Static interface to the Libbulletjme native library.
NativeLibraryLoader - Class in com.jme3.system
Utility class to load native libraries.
nativeMargin() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Return the native collision margin of this shape.
NativePhysicsObject - Class in com.jme3.bullet
An abstract class to represent a native (Bullet) physics object.
NativePhysicsObject() - Constructor for class com.jme3.bullet.NativePhysicsObject
Instantiate with no tracker and no assigned native object.
NativeSoftBodyUtil - Class in com.jme3.bullet.util
A utility class for interfacing with Native Bullet, specifically for soft bodies.
ne(Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Test whether 2 quaternions are distinct, without distinguishing 0 from -0.
ne(Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVector3f
Test whether 2 vectors are distinct, without distinguishing 0 from -0.
needsCollision(PhysicsCollisionObject, PhysicsCollisionObject) - Method in class com.jme3.bullet.CollisionSpace
Callback to determine whether the specified objects should be allowed to collide.
negate() - Method in class com.jme3.math.Vector3f
Returns the negative.
negateLocal() - Method in class com.jme3.math.Vector3f
Negates all 3 components and returns the (modified) current instance.
New6Dof - Class in com.jme3.bullet.joints
A 6 degree-of-freedom Constraint based on Bullet's btGeneric6DofSpring2Constraint.
New6Dof(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, Matrix3f, Matrix3f, RotationOrder) - Constructor for class com.jme3.bullet.joints.New6Dof
Instantiate a double-ended New6Dof constraint with all rotation DOFs free and all translation DOFs locked.
New6Dof(PhysicsRigidBody, Vector3f, Vector3f, Matrix3f, Matrix3f, RotationOrder) - Constructor for class com.jme3.bullet.joints.New6Dof
Instantiate a single-ended New6Dof constraint with all rotation DOFs free and all translation DOFs locked.
newEmptySoftBody() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Create an empty btSoftBody for this PhysicsSoftBody, using the pre-existing worldInfo.
newEmptySoftBody() - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Create an empty btReducedDeformableBody for this ReducedDeformableBody, using the pre-existing worldInfo.
NewHinge - Class in com.jme3.bullet.joints
A 3 degree-of-freedom Constraint that mimics ODE's Hinge2 joint, such as might be used to model one of the front wheels on a motor vehicle.
NewHinge(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.joints.NewHinge
Instantiate a double-ended constraint.
newInstance(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Quaternion, RotationOrder) - Static method in class com.jme3.bullet.joints.New6Dof
Instantiate a double-ended New6Dof constraint with all rotation DOFs free and all translation DOFs locked at zero.
nextFillMode() - Method in class vhacd4.Vhacd4Parameters
Advance the fill mode to the next value.
nextFloat(float, float) - Method in class jme3utilities.math.noise.Generator
Generate a single-precision value, uniformly distributed between 2 extremes.
nextInt(int, int) - Method in class jme3utilities.math.noise.Generator
Generate an integer value, uniformly distributed between 2 extremes.
nextQuaternion(Quaternion) - Method in class jme3utilities.math.noise.Generator
Generate a uniformly distributed, pseudo-random unit quaternion.
nextUnitVector3f(Vector3f) - Method in class jme3utilities.math.noise.Generator
Generate a uniformly distributed, pseudo-random unit vector.
nextVector3f(Vector3f) - Method in class jme3utilities.math.noise.Generator
Generate a pseudo-random vector that is uniformly distributed throughout the unit sphere centered on the origin.
NNCG - Enum constant in enum class com.jme3.bullet.SolverType
btNNCGConstraintSolver: using the Non-smooth Nonlinear Conjugate Gradient (NNCG) method
NO_CONTACT_RESPONSE - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag for an object with no contact response, such as a PhysicsGhostObject
NoCone - Static variable in class com.jme3.bullet.SolverMode
disable implicit cone friction
NodeDamping - Enum constant in enum class com.jme3.bullet.objects.infos.Cluster
node-damping coefficient (default=0, native field: m_ndamping)
nodeIndex() - Method in class com.jme3.bullet.joints.Anchor
Return the index of the anchored node in body A.
nodeLocation(int, Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the location of the indexed node.
nodeMass(int) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Read the mass of the indexed node.
nodeNormal(int, Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the normal vector of the indexed node.
NodesInClusters - Enum constant in enum class jme3utilities.minie.DumpFlags
soft-body nodes in clusters
NodesInSofts - Enum constant in enum class jme3utilities.minie.DumpFlags
nodes in soft bodies
nodeVelocity(int, Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the velocity of the indexed node.
none - Static variable in class com.jme3.bullet.collision.AfMode
no anisotropic friction (native name: CF_ANISOTROPIC_FRICTION_DISABLED)
nonEmpty(float[], String) - Static method in class jme3utilities.Validate
Validate a non-null, non-empty float array as a method argument.
nonEmpty(Object[], String) - Static method in class jme3utilities.Validate
Validate a non-null, non-empty object array as a method argument.
nonEmpty(String, String) - Static method in class jme3utilities.Validate
Validate a non-null, non-empty string as a method argument.
nonEmpty(Collection, String) - Static method in class jme3utilities.Validate
Validate a non-null, non-empty collection as a method argument.
nonNegative(float, String) - Static method in class jme3utilities.Validate
Validate a non-negative single-precision value as a method argument.
nonNegative(int, String) - Static method in class jme3utilities.Validate
Validate a non-negative integer as a method argument.
nonNegative(Vector3f, String) - Static method in class jme3utilities.Validate
Validate a non-negative Vector3f as a method argument.
nonNull(Object, String) - Static method in class jme3utilities.Validate
Validate a non-null reference.
nonZero(long, String) - Static method in class jme3utilities.Validate
Validate a non-zero long value as a method argument.
nonZero(Quaternion, String) - Static method in class jme3utilities.Validate
Validate a non-zero Quaternion as a method argument.
nonZero(Vector3f, String) - Static method in class jme3utilities.Validate
Validate a non-zero Vector3f as a method argument.
nonZero(Quatd, String) - Static method in class jme3utilities.Validate
Validate a non-zero Quatd as a method argument.
norm() - Method in class com.jme3.math.Quaternion
Returns the norm, defined as the dot product of the quaternion with itself.
normal - Variable in class com.jme3.math.Plane
Vector normal to the plane.
normalize() - Method in class com.jme3.math.Vector3f
Normalizes the vector to length=1 and returns the result as a new instance.
normalizeLocal() - Method in class com.jme3.math.Quaternion
Scales the quaternion to have norm=1 and returns the (modified) current instance.
normalizeLocal() - Method in class com.simsilica.mathd.Quatd
Normalizes the current instance in place.
normalizeLocal() - Method in class com.simsilica.mathd.Vec3d
Normalize this vector in place.
normalizeLocal(Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Normalize the specified Quaternion in place.
normalizeLocal(Vector3f) - Static method in class jme3utilities.math.MyVector3f
Normalize the specified vector in place.
NoVelocityDependent - Static variable in class com.jme3.bullet.SolverMode
disable velocity-dependent friction direction
numAxes - Static variable in class jme3utilities.math.MyVector3f
number of axes in the coordinate system
numIterations() - Method in class com.jme3.bullet.SolverInfo
Determine the number of iterations (native field: m_numIterations).
numVectors() - Method in interface jme3utilities.math.VectorSet
Determine the number of values in this set.
numVectors() - Method in class jme3utilities.math.VectorSetUsingBuffer
Determine the number of values in this set.

O

onContactEnded(long) - Method in interface com.jme3.bullet.collision.ContactListener
Invoked immediately after a contact manifold is removed.
onContactEnded(long) - Method in class com.jme3.bullet.PhysicsSpace
Invoked by native code immediately after a contact manifold is destroyed.
onContactProcessed(PhysicsCollisionObject, PhysicsCollisionObject, long) - Method in interface com.jme3.bullet.collision.ContactListener
Invoked immediately after a contact point is refreshed without being removed.
onContactProcessed(PhysicsCollisionObject, PhysicsCollisionObject, long) - Method in class com.jme3.bullet.PhysicsSpace
Invoked by native code immediately after a contact point is refreshed without being destroyed.
onContactStarted(long) - Method in interface com.jme3.bullet.collision.ContactListener
Invoked immediately after a contact manifold is created.
onContactStarted(long) - Method in class com.jme3.bullet.PhysicsSpace
Invoked by native code immediately after a contact manifold is created.
onGround() - Method in class com.jme3.bullet.objects.infos.CharacterController
Test whether the character is on the ground.
onGround() - Method in class com.jme3.bullet.objects.PhysicsCharacter
Test whether this character is on the ground.
orientation(Quaternion) - Method in class com.jme3.bullet.MultiBodyLink
Determine the orientation of the link relative to its parent when Q=0.
overrideIterations(int) - Method in class com.jme3.bullet.joints.Constraint
Override the number of iterations used to solve this Constraint.

P

pairTest(PhysicsCollisionObject, PhysicsCollisionObject, PhysicsCollisionListener) - Method in class com.jme3.bullet.CollisionSpace
Perform a pair test.
parent2Link(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the offset of the link's center relative to its parent's center for a planar joint.
parent2Pivot(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the offset from the parent's center to the pivot for a non-planar joint.
partId(int) - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Return the part index of the specified node.
partIndex() - Method in class com.jme3.bullet.collision.PhysicsRayTestResult
Read the part index at the point of contact.
partIndex() - Method in class com.jme3.bullet.collision.PhysicsSweepTestResult
Return the part index at the point of contact.
Pcos - Enum constant in enum class jme3utilities.minie.DumpFlags
collision objects in physics spaces
PcoType - Class in com.jme3.bullet.collision
Named constants for types of PhysicsCollisionObject.
penetrationDepthSolver() - Method in class com.jme3.bullet.CollisionConfiguration
Return which penetration-depth solver is used.
PersistentManifolds - Class in com.jme3.bullet.collision
Utility class to access fields of Bullet's btPersistentManifold class.
PGS - Enum constant in enum class com.jme3.bullet.SolverType
btSolveProjectedGaussSeidel: slow MLCP direct solver using projected Gauss-Seidel (PGS) for debug/learning purposes
phi - Static variable in class jme3utilities.math.MyMath
golden ratio = 1.618...
PhysicsBody - Class in com.jme3.bullet.objects
The abstract base class for rigid bodies and soft bodies.
PhysicsBody() - Constructor for class com.jme3.bullet.objects.PhysicsBody
Instantiate a PhysicsBody.
PhysicsCharacter - Class in com.jme3.bullet.objects
A collision object for simplified character simulation, based on Bullet's btKinematicCharacterController.
PhysicsCharacter(ConvexShape, float) - Constructor for class com.jme3.bullet.objects.PhysicsCharacter
Instantiate a responsive character with the specified CollisionShape and step height.
PhysicsCollisionEvent - Class in com.jme3.bullet.collision
Describe a point of contact between 2 collision objects in a PhysicsSpace, based on Bullet's btManifoldPoint.
PhysicsCollisionEvent(PhysicsCollisionObject, PhysicsCollisionObject, long) - Constructor for class com.jme3.bullet.collision.PhysicsCollisionEvent
Instantiate an event.
PhysicsCollisionListener - Interface in com.jme3.bullet.collision
Interface to receive notifications when 2 collision objects collide.
PhysicsCollisionObject - Class in com.jme3.bullet.collision
The abstract base class for collision objects based on Bullet's btCollisionObject.
PhysicsCollisionObject() - Constructor for class com.jme3.bullet.collision.PhysicsCollisionObject
Instantiate a collision object with no tracker and no assigned native object.
PhysicsDescriber - Class in jme3utilities.minie
Generate compact textual descriptions of physics objects for debugging purposes.
PhysicsDescriber() - Constructor for class jme3utilities.minie.PhysicsDescriber
Instantiate a describer with the default separator.
PhysicsDumper - Class in jme3utilities.minie
Dump Minie data structures for debugging purposes.
PhysicsDumper() - Constructor for class jme3utilities.minie.PhysicsDumper
Instantiate a PhysicsDumper that uses System.out for output.
PhysicsDumper(PrintStream) - Constructor for class jme3utilities.minie.PhysicsDumper
Instantiate a PhysicsDumper that uses the specified output stream.
PhysicsGhostObject - Class in com.jme3.bullet.objects
A collision object for intangibles, based on Bullet's btPairCachingGhostObject.
PhysicsGhostObject(CollisionShape) - Constructor for class com.jme3.bullet.objects.PhysicsGhostObject
Instantiate a ghost object with the specified CollisionShape.
PhysicsJoint - Class in com.jme3.bullet.joints
The abstract base class for physics joints based on Bullet's btTypedConstraint, btSoftBody::Anchor, or btSoftBody::Joint.
PhysicsJoint() - Constructor for class com.jme3.bullet.joints.PhysicsJoint
Instantiate a PhysicsJoint.
PhysicsRayTestResult - Class in com.jme3.bullet.collision
Represent the results of a Bullet ray test.
PhysicsRigidBody - Class in com.jme3.bullet.objects
A collision object to simulate a rigid body, based on Bullet's btRigidBody.
PhysicsRigidBody(CollisionShape) - Constructor for class com.jme3.bullet.objects.PhysicsRigidBody
Instantiate a responsive, dynamic body with mass=1 and the specified CollisionShape.
PhysicsRigidBody(CollisionShape, float) - Constructor for class com.jme3.bullet.objects.PhysicsRigidBody
Instantiate a responsive dynamic or static body with the specified CollisionShape and mass.
PhysicsSoftBody - Class in com.jme3.bullet.objects
A collision object to simulate a soft body, based on Bullet's btSoftBody.
PhysicsSoftBody() - Constructor for class com.jme3.bullet.objects.PhysicsSoftBody
Instantiate an empty soft body.
PhysicsSoftBody(boolean) - Constructor for class com.jme3.bullet.objects.PhysicsSoftBody
Instantiate an uninitialized soft body, for internal use.
PhysicsSoftSpace - Class in com.jme3.bullet
A PhysicsSpace that supports soft bodies, with its own btSoftRigidDynamicsWorld.
PhysicsSoftSpace(PhysicsSpace.BroadphaseType) - Constructor for class com.jme3.bullet.PhysicsSoftSpace
Instantiate a PhysicsSoftSpace with a sequential-impulse solver.
PhysicsSoftSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType) - Constructor for class com.jme3.bullet.PhysicsSoftSpace
Instantiate a PhysicsSoftSpace with a sequential-impulse solver.
PhysicsSoftSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, CollisionConfiguration) - Constructor for class com.jme3.bullet.PhysicsSoftSpace
Instantiate a PhysicsSoftSpace with a sequential-impulse solver.
PhysicsSpace - Class in com.jme3.bullet
A CollisionSpace to simulate dynamic physics, with its own btDiscreteDynamicsWorld.
PhysicsSpace(PhysicsSpace.BroadphaseType) - Constructor for class com.jme3.bullet.PhysicsSpace
Instantiate a PhysicsSpace with sequential-impulse solvers.
PhysicsSpace(Vector3f, Vector3f) - Constructor for class com.jme3.bullet.PhysicsSpace
Instantiate a PhysicsSpace with an AXIS_SWEEP_3 broadphase accelerator and sequential-impulse solvers.
PhysicsSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType) - Constructor for class com.jme3.bullet.PhysicsSpace
Instantiate a PhysicsSpace with sequential-impulse solvers.
PhysicsSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, int) - Constructor for class com.jme3.bullet.PhysicsSpace
Instantiate a PhysicsSpace with the specified number of sequential-impulse solvers.
PhysicsSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, int, CollisionConfiguration) - Constructor for class com.jme3.bullet.PhysicsSpace
Instantiate a PhysicsSpace with the specified number of sequential-impulse solvers.
PhysicsSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, SolverType) - Constructor for class com.jme3.bullet.PhysicsSpace
Instantiate a PhysicsSpace with the specified contact-and-constraint solver.
PhysicsSpace(Vector3f, Vector3f, PhysicsSpace.BroadphaseType, SolverType, CollisionConfiguration) - Constructor for class com.jme3.bullet.PhysicsSpace
Instantiate a PhysicsSpace with the specified contact-and-constraint solver.
PhysicsSpace.BroadphaseType - Enum Class in com.jme3.bullet
Enumerate the available accelerators for broadphase collision detection.
PhysicsSweepTestResult - Class in com.jme3.bullet.collision
Represent the results of a Bullet sweep test.
physicsTick(PhysicsSpace, float) - Method in interface com.jme3.bullet.PhysicsTickListener
Callback invoked just after the physics has been stepped.
PhysicsTickListener - Interface in com.jme3.bullet
Callback interface from the physics thread, used to clear/apply forces.
physicsTransform(Transform) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Calculate the body's physics transform.
PhysicsVehicle - Class in com.jme3.bullet.objects
A rigid body for simplified vehicle simulation based on Bullet's btRaycastVehicle.
PhysicsVehicle(CollisionShape) - Constructor for class com.jme3.bullet.objects.PhysicsVehicle
Instantiate a responsive vehicle with the specified CollisionShape and mass=1.
PhysicsVehicle(CollisionShape, float) - Constructor for class com.jme3.bullet.objects.PhysicsVehicle
Instantiate a responsive vehicle with the specified CollisionShape and mass.
PI - Static variable in class com.jme3.math.FastMath
The value PI as a float.
pick(E[]) - Method in class jme3utilities.math.noise.Generator
Pick a pseudo-random element from the specified array.
pinNode(int) - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Pin a node.
pivot2Link(Vector3f) - Method in class com.jme3.bullet.MultiBodyLink
Determine the offset from the pivot to this link's center for a non-planar joint.
pivotA - Variable in class com.jme3.bullet.joints.Constraint
copy of the pivot location: in physics-space coordinates if bodyA is null, or else in A's scaled local coordinates
pivotB - Variable in class com.jme3.bullet.joints.Constraint
copy of the pivot location: in physics-space coordinates if bodyB is null, or else in B's scaled local coordinates
Planar - Enum constant in enum class com.jme3.bullet.MultiBodyJointType
planar joint (native name: ePlanar)
Plane - Class in com.jme3.math
Plane defines a plane where Normal dot (x,y,z) = Constant.
Plane(Vector3f, float) - Constructor for class com.jme3.math.Plane
Constructor instantiates a new Plane object.
Plane(Vector3f, Vector3f) - Constructor for class com.jme3.math.Plane
Constructor instantiates a new Plane object.
PlaneCollisionShape - Class in com.jme3.bullet.collision.shapes
A planar collision shape based on Bullet's btStaticPlaneShape.
PlaneCollisionShape(Plane) - Constructor for class com.jme3.bullet.collision.shapes.PlaneCollisionShape
Instantiate a plane shape defined by the specified plane.
Platform - Enum Class in com.jme3.system
Enumerate known operating system/architecture pairs.
Platform.Os - Enum Class in com.jme3.system
Enumerate generic names of operating systems
Point2PointJoint - Class in com.jme3.bullet.joints
A 3 degree-of-freedom joint based on Bullet's btPoint2PointConstraint.
Point2PointJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.joints.Point2PointJoint
Instantiate a double-ended Point2PointJoint.
Point2PointJoint(PhysicsRigidBody, Vector3f) - Constructor for class com.jme3.bullet.joints.Point2PointJoint
Instantiate a single-ended Point2PointJoint where the constraint is already satisfied.
Point2PointJoint(PhysicsRigidBody, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.joints.Point2PointJoint
Instantiate a single-ended Point2PointJoint where the constraint might not be satisfied yet.
PoseMatching - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
pose-matching coefficient: how strongly the soft body will tend to return to its default pose (≥0, ≤1, default=0, native field: kMT)
positionIterations() - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Return the number of position-solver iterations (native field: piterations).
positive(float, String) - Static method in class jme3utilities.Validate
Validate a positive single-precision value as a method argument.
positive(int, String) - Static method in class jme3utilities.Validate
Validate a positive integer value as a method argument.
positive(Vector3f, String) - Static method in class jme3utilities.Validate
Validate an all-positive Vector3f as a method argument.
postRebuild() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
For use by subclasses.
postRebuild() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Invoked during a rebuild after the native object is created.
pow(float, float) - Static method in class com.jme3.math.FastMath
Returns a number raised to an exponent power.
pow(Quaternion, float, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Raise a normalized quaternion to the specified real power.
prePhysicsTick(PhysicsSpace, float) - Method in interface com.jme3.bullet.PhysicsTickListener
Callback invoked just before the physics is stepped.
preRebuild() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
For use by subclasses.
Pressure - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
pressure coefficient (default=0, native field: kPR)
PrimitiveAllocator - Class in com.jme3.util
Allocate direct buffers without special logic.
PrimitiveAllocator() - Constructor for class com.jme3.util.PrimitiveAllocator
Instantiate an allocator.
principalAxes(FloatBuffer, Transform, Vector3f) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Calculates the coordinate transform to be applied to a rigid body in order for this shape to be centered on its center of mass and its principal axes to coincide with its local axes.
Prismatic - Enum constant in enum class com.jme3.bullet.MultiBodyJointType
prismatic joint (native name: ePrismatic)
proxyGroup() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision group of the collision object's broadphase proxy.
proxyMask() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision mask of this object's broadphase proxy.
pseudoDistance(Vector3f) - Method in class com.jme3.math.Plane
pseudoDistance calculates the distance from this plane to a provided point.
put(int) - Method in class jme3utilities.lbj.IndexBuffer
Write the specified index at the current read/write position, then increment the position.
put(int, int) - Method in class jme3utilities.lbj.IndexBuffer
Write the specified index at the specified buffer position.
put(FloatBuffer, int, Vector3f) - Static method in class jme3utilities.math.MyBuffer
Write a Vector3f starting at the specified position.

Q

QUARTER_PI - Static variable in class com.jme3.math.FastMath
The value PI/4 as a float.
quat1 - Variable in class com.jme3.util.TempVars
General quaternions.
Quatd - Class in com.simsilica.mathd
Used to efficiently represent rotations and orientations in 3-dimensional space, without risk of gimbal lock.
Quatd() - Constructor for class com.simsilica.mathd.Quatd
Instantiates an identity quaternion: all components zeroed except w, which is set to 1.
Quatd(double, double, double, double) - Constructor for class com.simsilica.mathd.Quatd
Instantiates a quaternion with the specified components.
Quatd(Quaternion) - Constructor for class com.simsilica.mathd.Quatd
Instantiates based on the specified (single-precision) Quaternion.
Quatd(Quatd) - Constructor for class com.simsilica.mathd.Quatd
Instantiates a copy of the argument.
Quaternion - Class in com.jme3.math
Used to efficiently represent rotations and orientations in 3-dimensional space, without risk of gimbal lock.
Quaternion() - Constructor for class com.jme3.math.Quaternion
Instantiates an identity quaternion: all components zeroed except w, which is set to 1.
Quaternion(float, float, float, float) - Constructor for class com.jme3.math.Quaternion
Instantiates a quaternion with the specified components.
Quaternion(Quaternion) - Constructor for class com.jme3.math.Quaternion
Instantiates a copy of the argument.
quote(CharSequence) - Static method in class jme3utilities.MyString
Enclose the specified text in quotation marks and escape all tab, quote, newline, and backslash characters.

R

RAD_TO_DEG - Static variable in class com.jme3.math.FastMath
A value to multiply a radian value by, to convert it to degrees.
randomizeConstraints() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Randomize constraints to reduce solver bias.
RandomOrder - Static variable in class com.jme3.bullet.SolverMode
randomize order
RaycastFill - Enum constant in enum class com.jme3.bullet.FillMode
use raycasting to distinguish inside from outside (native name: RAYCAST_FILL)
rayTest(Vector3f, Vector3f) - Method in class com.jme3.bullet.CollisionSpace
Perform a ray-collision test (raycast) and sort the results by ascending hitFraction.
rayTest(Vector3f, Vector3f, List<PhysicsRayTestResult>) - Method in class com.jme3.bullet.CollisionSpace
Perform a ray-collision test (raycast) and sort the results by ascending hitFraction.
rayTestDp(Vec3d, Vec3d, List<PhysicsRayTestResult>) - Method in class com.jme3.bullet.CollisionSpace
Perform a ray-collision test (raycast) and sort the results by ascending hitFraction.
RayTestFlag - Class in com.jme3.bullet
Named flags for use with a ray test.
rayTestRaw(Vector3f, Vector3f) - Method in class com.jme3.bullet.CollisionSpace
Perform a ray-collision test (raycast) and return the results in arbitrary order.
rayTestRaw(Vector3f, Vector3f, List<PhysicsRayTestResult>) - Method in class com.jme3.bullet.CollisionSpace
Perform a ray-collision test (raycast) and return the results in arbitrary order.
reassignNativeId(long) - Method in class com.jme3.bullet.NativePhysicsObject
Assign a tracked native object to this instance, unassigning (but not freeing) any previously assigned one.
rebuildRigidBody() - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Rebuild the rigid body with a new native object.
recalculateAabb() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Recalculate this shape's bounding box if necessary.
recalculateAabb() - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Recalculate this shape's bounding box if necessary.
recalculateAabb() - Method in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Recalculate this shape's bounding box if necessary.
recalculateAabb() - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Recalculate the shape's bounding box if necessary.
recalculateAabb() - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Recalculate this shape's bounding box if necessary.
recalculateAabb() - Method in class com.jme3.bullet.collision.shapes.MultiSphere
Recalculate the shape's bounding box if necessary.
recalculateAabb() - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Recalculate the shape's bounding box if necessary.
RectangularSolid - Class in jme3utilities.math
A rectangular solid whose axes might not be aligned with the world axes.
RectangularSolid() - Constructor for class jme3utilities.math.RectangularSolid
Instantiate a zero-extent rectangular solid at the origin.
RectangularSolid(Vector3f) - Constructor for class jme3utilities.math.RectangularSolid
Instantiate a centered solid with the specified half extents.
ReducedDeformableBody - Class in com.jme3.bullet.objects
A simplified soft body embedded in a rigid frame, based on Bullet's btReducedDeformableBody.
ReducedDeformableBody(Vector3f[], float[]) - Constructor for class com.jme3.bullet.objects.ReducedDeformableBody
Instantiate a deformable body with the specified nodes.
release() - Method in class com.jme3.util.TempVars
Releases this instance of TempVars.
releaseAllClusters() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Release all clusters.
releaseCluster(int) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Release the indexed cluster.
remove(Object) - Method in class com.jme3.bullet.CollisionSpace
Remove the specified object from the space.
remove(Object) - Method in class com.jme3.bullet.MultiBodySpace
Remove the specified object from this space.
remove(Object) - Method in class com.jme3.bullet.PhysicsSpace
Remove the specified object from the space.
removeChildShape(CollisionShape) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Purge all references to the specified child shape from this shape.
removeCollideWithGroup(int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Remove collision groups from the set with which this object can collide.
removeCollisionObject(PhysicsCollisionObject) - Method in class com.jme3.bullet.CollisionSpace
Remove the specified collision object from the space.
removeCollisionObject(PhysicsCollisionObject) - Method in class com.jme3.bullet.DeformableSpace
Remove the specified collision object from this space.
removeCollisionObject(PhysicsCollisionObject) - Method in class com.jme3.bullet.PhysicsSoftSpace
Remove the specified collision object from this space.
removeCollisionObject(PhysicsCollisionObject) - Method in class com.jme3.bullet.PhysicsSpace
Remove the specified collision object from the space.
removeFromIgnoreList(PhysicsCollisionObject) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Remove a collision object from this object's ignore list and vice versa.
removeJoint(PhysicsJoint) - Method in class com.jme3.bullet.objects.PhysicsBody
Do not invoke directly! Joints are removed automatically when destroyed.
removeJoint(PhysicsJoint) - Method in class com.jme3.bullet.PhysicsSpace
Remove the specified PhysicsJoint from the space.
removeMultiBody(MultiBody) - Method in class com.jme3.bullet.MultiBodySpace
Remove the specified MultiBody and all its colliders.
removeProgressListener(VHACDProgressListener) - Static method in class vhacd.VHACD
De-register the specified progress listener.
removeProgressListener(VHACDProgressListener) - Static method in class vhacd4.Vhacd4
De-register the specified progress listener.
removeSuffix(String, String) - Static method in class jme3utilities.MyString
Extract the remainder of the specified string after removing the specified suffix.
removeTickListener(PhysicsTickListener) - Method in class com.jme3.bullet.PhysicsSpace
De-register the specified tick listener.
removeWheel(int) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Remove a wheel.
require(boolean, String) - Static method in class jme3utilities.Validate
Validate an arbitrary boolean-valued expression involving method arguments.
reset(PhysicsSpace) - Method in class com.jme3.bullet.objects.infos.CharacterController
Reset this controller, including its velocity.
reset(PhysicsSpace) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Reset this character, including its velocity.
resetQuickprof() - Static method in class com.jme3.bullet.util.NativeLibrary
Reset Quickprof.
resetRestingLengths() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Set the resting lengths of all links to their current lengths.
resetSuspension() - Method in class com.jme3.bullet.objects.infos.VehicleController
Reset the vehicle's suspension.
resetSuspension() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Reset this vehicle's suspension.
restingLengthsScale() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Read the scale factor for resting lengths.
Revolute - Enum constant in enum class com.jme3.bullet.MultiBodyJointType
revolute joint (native name: eRevolute)
rightAxisIndex() - Method in class com.jme3.bullet.objects.infos.VehicleController
Determine the index of the vehicle's right-side axis.
rightAxisIndex() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the index of this vehicle's right-side axis.
rigid - Static variable in class com.jme3.bullet.collision.PcoType
value for a PhysicsVehicle chassis or PhysicsRigidBody (native name: CO_RIGID_BODY)
RigidBodyMotionState - Class in com.jme3.bullet.objects.infos
The motion state (transform) of a rigid body, with thread-safe access.
RigidBodyMotionState() - Constructor for class com.jme3.bullet.objects.infos.RigidBodyMotionState
Instantiate a motion state.
RigidBodySnapshot - Class in com.jme3.bullet.objects.infos
Copy certain properties of a PhysicsRigidBody in order to re-apply them later.
RigidBodySnapshot(PhysicsRigidBody) - Constructor for class com.jme3.bullet.objects.infos.RigidBodySnapshot
Instantiate a snapshot of the specified body.
RigidHardness - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
contact hardness coefficient for dynamic rigid bodies (≥0, ≤1, default=1, native field: kCHR)
rolling - Static variable in class com.jme3.bullet.collision.AfMode
anisotropic rolling friction mode (native name: CF_ANISOTROPIC_ROLLING_FRICTION)
root2 - Static variable in class jme3utilities.math.MyMath
square root of 2
rootHalf - Static variable in class jme3utilities.math.MyMath
square root of 1/2
rotate(Matrix3f) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Apply the specified rotation (in the parent's coordinate system) to each child.
rotate(Quaternion, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyQuaternion
Rotate the input vector using the specified quaternion.
rotate(FloatBuffer, int, int, Quaternion) - Static method in class jme3utilities.math.MyBuffer
Apply the specified rotation to 3-D vectors in the specified FloatBuffer range.
rotateInverse(Quaternion, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyQuaternion
Rotate the input vector using the inverse of the specified quaternion.
RotationalLimitMotor - Class in com.jme3.bullet.joints.motors
A motor based on Bullet's btRotationalLimitMotor, used to control the rotation of a SixDofJoint.
RotationalLimitMotor(long) - Constructor for class com.jme3.bullet.joints.motors.RotationalLimitMotor
Instantiate a motor.
RotationMotor - Class in com.jme3.bullet.joints.motors
A single-axis motor based on Bullet's btRotationalLimitMotor2, used to control the rotation of a New6Dof constraint.
RotationMotor(long) - Constructor for class com.jme3.bullet.joints.motors.RotationMotor
Instantiate a motor.
RotationOrder - Enum Class in com.jme3.bullet
Enumerate the orders in which axis rotations can be applied (native enum: RotateOrder).

S

Sbcp - Enum Class in com.jme3.bullet.objects.infos
Enumerate the float-valued parameters in a SoftBodyConfig.
scale - Variable in class com.jme3.bullet.collision.shapes.CollisionShape
copy of the scale factors, one for each local axis
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.BoxCollisionShape
Estimate the volume of the collision shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Estimate the volume of the shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Estimate the volume of this shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Estimate the volume of this shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.ConicalFrustum
Estimate the volume of the collision shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.ConvexShape
Estimate the volume of this shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.EmptyShape
Return the volume of the shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.MultiSphere
Estimate the volume of the shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.SphereCollisionShape
Estimate the volume of this shape, including scale and margin.
scaledVolume() - Method in class com.jme3.bullet.collision.shapes.SphericalSegment
Estimate the volume of the collision shape, including scale and margin.
SDF_MDF - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the GJK-based handler for multibody-versus-deformable face collisions
SDF_RD - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the SDF-based handler for rigid-versus-deformable collisions
SDF_RDF - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the GJK-based handler for rigid-versus-deformable face collisions
SDF_RDN - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the SDF-based handler for rigid-versus-deformable node collisions
SDF_RS - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the SDF-based handler for rigid-versus-soft collisions
SelfImpulse - Enum constant in enum class com.jme3.bullet.objects.infos.Cluster
self-collision impulse factor (default=0.01, native field: m_selfCollisionImpulseFactor)
Separate - Static variable in class com.jme3.bullet.SolverMode
friction separate
serialize() - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Serialize the hierarchy to a byte array.
serializeBvh() - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Serialize the BVH to a byte array.
ServoTarget - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
servo's target (m_servoTarget, default=0)
set(double, double, double) - Method in class com.simsilica.mathd.Vec3d
Sets all 3 components to specified values.
set(double, double, double, double) - Method in class com.simsilica.mathd.Quatd
Sets all 4 components to the specified values.
set(float, float, float) - Method in class com.jme3.math.Vector3f
Sets all 3 components to specified values.
set(float, float, float, float) - Method in class com.jme3.math.Quaternion
Sets all 4 components to specified values.
set(int, double) - Method in class com.simsilica.mathd.Vec3d
Alters the indexed component.
set(int, float) - Method in class com.jme3.math.Vector3f
Sets the indexed component.
set(int, int, float) - Method in class com.jme3.math.Matrix3f
Sets the specified element.
set(int, Vector3f) - Method in class com.jme3.math.Triangle
Alters the location of the indexed vertex and deletes the stored normal.
set(MotorParam, float) - Method in class com.jme3.bullet.joints.motors.RotationMotor
Alter the specified parameter.
set(MotorParam, int, float) - Method in class com.jme3.bullet.joints.New6Dof
Alter the specified parameter for the indexed degree of freedom.
set(MotorParam, Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Alter the specified parameter of this motor.
set(Cluster, int, float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the specified parameter of the indexed cluster.
set(Sbcp, float) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Alter the specified parameter.
set(Matrix3f) - Method in class com.jme3.math.Matrix3f
Copies the matrix argument.
set(Quaternion) - Method in class com.jme3.math.Matrix3f
Configures as a rotation matrix equivalent to the argument.
set(Quaternion) - Method in class com.jme3.math.Quaternion
Copies all 4 components from the argument.
set(Quaternion) - Method in class com.simsilica.mathd.Quatd
Copies all 4 components of the specified (single-precision) Quaternion to the current instance.
set(TransformDp) - Method in class com.jme3.math.TransformDp
Copies all 3 components from the argument.
set(Vector3f) - Method in class com.jme3.math.Vector3f
Copies all 3 components from the argument.
set(Vector3f) - Method in class com.simsilica.mathd.Vec3d
Copies all 3 components from the argument, converting them to double precision.
set(Vector3f, Vector3f, Vector3f) - Method in class com.jme3.math.Triangle
Alters the locations of all 3 vertices and deletes the stored normal.
set(Matrix3d) - Method in class com.simsilica.mathd.Matrix3d
Copies all elements of the argument to the current instance.
set(Quatd) - Method in class com.simsilica.mathd.Quatd
Copies all 4 components from the argument.
set(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Copies all 3 components from the argument.
set(Vec3d, Quatd, Vec3d) - Method in class com.jme3.math.TransformDp
Sets all 3 components to the specified values.
set1(Vector3f) - Method in class com.jme3.math.Triangle
Alters the location of the first vertex and deletes the stored normal.
set2(Vector3f) - Method in class com.jme3.math.Triangle
Alters the location of the 2nd vertex and deletes the stored normal.
set3(Vector3f) - Method in class com.jme3.math.Triangle
Alters the location of the 3rd vertex and deletes the stored normal.
setAccumulatedImpulse(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter the accumulated impulse (native field: m_accumulatedImpulse).
setAccumulatedImpulse(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter the accumulated impulse (native field: m_accumulatedImpulse).
setAccuracy(float) - Method in class com.jme3.bullet.PhysicsSpace
Alter the accuracy (time step used when maxSubSteps>0).
setACDMode(ACDMode) - Method in class vhacd.VHACDParameters
Set approximate convex decomposition mode (native field: m_mode).
setActivationState(long, int) - Static method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the activation state of the collision object.
setAerodynamics(Aero) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Alter the aerodynamics model.
setAirDensity(float) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Alter the air density.
setAlpha(double) - Method in class vhacd.VHACDParameters
Set bias toward clipping along symmetry planes (native field: m_alpha).
setAngularDamping(float) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's angular damping.
setAngularDamping(float) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's angular damping.
setAngularDamping(float) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's angular damping.
setAngularFactor(float) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's angular factor.
setAngularFactor(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's angular factors, used to scale applied torques.
setAngularLowerLimit(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Alter the joint's lower limits for rotation of all 3 axes.
setAngularOnly(boolean) - Method in class com.jme3.bullet.joints.ConeJoint
Alter whether this joint is angular-only.
setAngularOnly(boolean) - Method in class com.jme3.bullet.joints.HingeJoint
Alter whether this joint is angular-only, meaning no constraints on translation.
setAngularSleepingThreshold(float) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's angular-motion sleeping threshold.
setAngularStiffness(float) - Method in class com.jme3.bullet.objects.infos.SoftBodyMaterial
Alter the angular-stiffness coefficient (native field: m_kAST).
setAngularUpperLimit(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Alter the joint's upper limits for rotation of all 3 axes.
setAngularVelocity(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's angular velocity.
setAngularVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's angular velocity.
setAngularVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's angular velocity.
setAngularVelocityDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's angular velocity.
setAnisotropicFriction(Vector3f, int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter this object's anisotropic friction (native field: m_anisotropicFriction).
setAppliedImpulse(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the applied impulse of the specified point (native field: m_appliedImpulse).
setAppliedImpulseLateral1(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the applied lateral impulse #1 of the specified point (native field: m_appliedImpulseLateral1).
setAppliedImpulseLateral2(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the applied lateral impulse #2 of the specified point (native field: m_appliedImpulseLateral2).
setApplyLocal(boolean) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter whether physics coordinates should match the local transform of the Spatial.
setApplyPhysicsLocal(boolean) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Alter whether physics-space coordinates should match the spatial's local coordinates.
setAsync(boolean) - Method in class vhacd4.Vhacd4Parameters
Alter whether V-HACD should run on a new thread (native field: m_asyncACD).
setAxis(Vector3f) - Method in class com.jme3.bullet.joints.SoftAngularJoint
Alter the joint axis.
setAxisA(Vector3f) - Method in class com.jme3.bullet.joints.GearJoint
Alter the A body's axis of rotation.
setAxisB(Vector3f) - Method in class com.jme3.bullet.joints.GearJoint
Alter the B body's axis of rotation.
setBaseAngularVelocity(Vector3f) - Method in class com.jme3.bullet.MultiBody
Alter the angular velocity of the base.
setBaseLocation(Vector3f) - Method in class com.jme3.bullet.MultiBody
Alter the location of the base's center of mass.
setBaseOrientation(Quaternion) - Method in class com.jme3.bullet.MultiBody
Alter the orientation of the base.
setBaseTransform(Transform) - Method in class com.jme3.bullet.MultiBody
Alter the transform of the base.
setBaseVelocity(Vector3f) - Method in class com.jme3.bullet.MultiBody
Alter the linear velocity of the base.
setBeta(double) - Method in class vhacd.VHACDParameters
Set bias toward clipping along revolution axes (native field: m_beta).
setBodyA(PhysicsBody) - Method in class com.jme3.bullet.joints.PhysicsJoint
Specify the body at the joint's "A" end.
setBodyB(PhysicsBody) - Method in class com.jme3.bullet.joints.PhysicsJoint
Specify the body at the joint's "B" end.
setBreakingImpulseThreshold(float) - Method in class com.jme3.bullet.joints.Constraint
Alter the breaking impulse threshold.
setCcdMotionThreshold(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the amount of motion required to trigger continuous collision detection (CCD) (native field: m_ccdMotionThreshold).
setCcdSweptSphereRadius(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the continuous collision detection (CCD) swept-sphere radius for this object (native field: m_ccdSweptSphereRadius).
setCcdWithStaticOnly(boolean) - Method in class com.jme3.bullet.PhysicsSpace
Alter whether CCD checks for collisions with static and kinematic bodies (native field: m_ccdWithStaticOnly).
setCFM(float) - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Set the constraint force mixing coefficient (aka CFM).
setChildTransform(CollisionShape, Transform) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Alter the local transform of the specified child CollisionShape.
setClusterIterations(int) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Alter the number of cluster-solver iterations (native field: citerations).
setCollideWithGroups(int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Directly alter the collision groups with which this object can collide.
setCollideWithGroups(int) - Method in class com.jme3.bullet.MultiBody
Directly alter the collision groups with which this MultiBody can collide.
setCollisionBetweenLinkedBodies(boolean) - Method in class com.jme3.bullet.joints.Constraint
Handle/ignore collisions between the ends of a double-ended joint.
setCollisionFlags(int, int...) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Alter the collision flags (default=SDF_RS).
setCollisionFlags(long, int) - Static method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the collision flags of the collision object (native field: m_collisionFlags).
setCollisionGroup(int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter which collision group this object belongs to.
setCollisionGroup(int) - Method in class com.jme3.bullet.MultiBody
Alter which collision group this MultiBody belongs to.
setCollisionShape(CollisionShape) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Apply the specified shape to the collision object.
setCollisionShape(CollisionShape) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Apply the specified CollisionShape to this character.
setCollisionShape(CollisionShape) - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Apply the specified CollisionShape to this object.
setCollisionShape(CollisionShape) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Apply the specified CollisionShape to the body.
setCombinedFriction(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the combined friction of the specified point (native field: m_combinedFriction).
setCombinedRestitution(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the combined restitution of the specified point (native field: m_combinedRestitution).
setCombinedRollingFriction(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the combined rolling friction of the specified point (native field: m_combinedRollingFriction).
setCombinedSpinningFriction(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the combined spinning friction of the specified point (native field: m_combinedSpinningFriction).
setConfig(SoftBodyConfig) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Replace the configuration properties.
setContactCalcArea3Points(boolean) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the number of points used to calculate the area of the convex hull of a contact point.
setContactDamping(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the contact damping (native field: m_contactDamping).
setContactErp(float) - Method in class com.jme3.bullet.SolverInfo
Alter the error-reduction parameter for contact constraints (native field: m_erp2).
setContactFilterEnabled(boolean) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Enable/disable contact filtering for this shape.
setContactMotion1(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the contact motion #1 of the specified point (native field: m_contactMotion1).
setContactMotion2(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the contact motion #2 of the specified point (native field: m_contactMotion2).
setContactProcessingThreshold(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the contact-processing threshold (native field: m_contactProcessingThreshold).
setContactResponse(boolean) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Enable/disable this character's contact response.
setContactResponse(boolean) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Enable/disable the body's contact response.
setContactStiffness(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the contact stiffness (native field: m_contactStiffness).
setConvexHullDownSampling(int) - Method in class vhacd.VHACDParameters
Set precision of the convex-hull generation process during the clipping plane selection stage (native field: m_convexhullDownsampling).
setCoordinateSystem(int, int, int) - Method in class com.jme3.bullet.objects.infos.VehicleController
Alter the coordinate system of the vehicle.
setCoordinateSystem(Vector3f, Vector3f, Vector3f) - Method in class com.jme3.bullet.objects.infos.VehicleController
Customize the coordinate system of the vehicle.
setDamping(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's damping (native field: m_damping).
setDamping(float) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's damping (native field: m_damping).
setDamping(float) - Method in class com.jme3.bullet.joints.Point2PointJoint
Alter the joint's damping.
setDamping(float, float) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's damping.
setDamping(float, float) - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Alter the Rayleigh damping parameters.
setDamping(int, float) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Alter the damping for the indexed degree of freedom.
setDamping(int, float, boolean) - Method in class com.jme3.bullet.joints.New6Dof
Alter the damping for the indexed degree of freedom.
setDampingDirAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's damping for on-axis rotation between the limits.
setDampingDirLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's damping for on-axis translation between the limits.
setDampingLimAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's damping for on-axis rotation hitting the limits.
setDampingLimited(boolean) - Method in class com.jme3.bullet.joints.motors.RotationMotor
Limit or unlimit the spring's damping (native field: m_springDampingLimited).
setDampingLimited(int, boolean) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Limit or unlimit the damping of the indexed spring (m_springDampingLimited).
setDampingLimLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's damping for on-axis translation hitting the limits.
setDampingOrthoAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's damping for off-axis rotation.
setDampingOrthoLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's damping for off-axis translation.
setDeactivationDeadline(float) - Static method in class com.jme3.bullet.objects.PhysicsBody
Alter the global deactivation deadline.
setDeactivationEnabled(boolean) - Static method in class com.jme3.bullet.objects.PhysicsBody
Alter the global deactivation enable flag.
setDeactivationTime(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the deactivation time (native field: m_deactivationTime).
setDebugEnabled(boolean) - Method in class vhacd.VHACDParameters
Alter whether debug output is enabled.
setDebugEnabled(boolean) - Method in class vhacd4.Vhacd4Parameters
Alter whether debug output is enabled.
setDefaultMargin(float) - Static method in class com.jme3.bullet.collision.shapes.CollisionShape
Alter the default margin for new shapes that are neither capsules nor spheres.
setDescriber(Describer) - Method in class jme3utilities.debug.Dumper
Replace the current Describer with the specified one.
setDistance1(long, float) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the separation distance of the specified point (native field: m_distance1).
setDriftIterations(int) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Alter the number of drift-solver iterations (native field: diterations).
setEnabled(boolean) - Method in class com.jme3.bullet.joints.Constraint
Enable or disable this Constraint.
setEnabled(int, boolean) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Enable or disable the indexed axis (native field: m_enableMotor).
setEnabled(DumpFlags, boolean) - Method in class jme3utilities.minie.PhysicsDumper
Configure the specified dump flag.
setEnableMotor(boolean) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Enable or disable this motor (native field: m_enableMotor).
setEnableSleep(boolean) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's activation state to allow/disallow sleeping.
setEquilibriumPoint() - Method in class com.jme3.bullet.joints.New6Dof
Alter the equilibrium points for all degrees of freedom, based on the constraint's current location/orientation.
setEquilibriumPoint() - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Alter the equilibrium points for all degrees of freedom, based on the joint's current location/orientation.
setEquilibriumPoint(int) - Method in class com.jme3.bullet.joints.New6Dof
Alter the equilibrium point of the indexed degree of freedom, based on the constraint's current location/orientation.
setEquilibriumPoint(int) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Alter the equilibrium point of the indexed degree of freedom, based on the joint's current location/orientation.
setEquilibriumPoint(int, float) - Method in class com.jme3.bullet.joints.New6Dof
Alter the equilibrium point of the indexed degree of freedom.
setERP(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's error-reduction parameter at the limits (native field: m_stopERP).
setERP(float) - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Set the error-reduction parameter (aka ERP).
setERP(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's error-reduction parameters at the limits (native field: m_stopERP).
setFallSpeed(float) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's maximum fall speed (terminal velocity).
setFallSpeed(float) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's maximum fall speed (terminal velocity).
setFeedback(boolean) - Method in class com.jme3.bullet.joints.Constraint
Enable or disable feedback for this Constraint.
setFillMode(FillMode) - Method in class vhacd4.Vhacd4Parameters
Specify the algorithm that fills voxels to create a solid object (native field: m_fillMode).
setFindBestPlane(boolean) - Method in class vhacd4.Vhacd4Parameters
Alter whether V-HACD should try to find the optimal location for splitting hulls (native field: m_findBestPlane).
setFlags(long, int) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the flags of the specified point (native field: m_contactPointFlags).
setForceUpdateAllAabbs(boolean) - Method in class com.jme3.bullet.CollisionSpace
Alter whether the bounding boxes of inactive collision objects should be recomputed during each update() (native field: m_forceUpdateAllAabbs).
setFriction(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the collision object's friction (native field: m_friction).
setFrictionSlip(float) - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Alter the friction between tires and ground (native field: m_frictionSlip).
setFrictionSlip(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the initial friction for new wheels.
setFrictionSlip(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter the friction between this wheel's tire and the ground (native field: m_frictionSlip).
setFrictionSlip(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the friction of the indexed wheel.
setFrontWheel(boolean) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter whether this wheel is a front (steering) wheel (native field: m_bIsFrontWheel).
setGlobalCfm(float) - Method in class com.jme3.bullet.SolverInfo
Alter the global constraint-force mixing parameter (native field: m_globalCfm).
setGravity(float) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter the character's gravitational acceleration without altering its "up" vector.
setGravity(Vector3f) - Method in class com.jme3.bullet.DeformableSpace
Alter the gravitational acceleration acting on newly-added bodies.
setGravity(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's gravitational acceleration.
setGravity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsBody
Alter this body's gravitational acceleration.
setGravity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's gravitational acceleration.
setGravity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's gravitational acceleration.
setGravity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter this body's gravitational acceleration.
setGravity(Vector3f) - Method in class com.jme3.bullet.PhysicsSoftSpace
Alter the gravitational acceleration acting on newly-added bodies.
setGravity(Vector3f) - Method in class com.jme3.bullet.PhysicsSpace
Alter the gravitational acceleration acting on newly-added bodies.
setGravity(Vector3f) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Alter the gravitational acceleration.
setGravityDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's gravitational acceleration.
setIgnoreList(PhysicsCollisionObject[]) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Replace the ignore list.
setImpulseClamp(float) - Method in class com.jme3.bullet.joints.Point2PointJoint
Alter the joint's impulse clamp.
setIndentIncrement(String) - Method in class jme3utilities.debug.Dumper
Configure the indent increment.
setInfluence(float) - Method in class com.jme3.bullet.joints.Anchor
Alter how much influence the anchor has on the bodies.
setInverseInertiaLocal(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the principal (diagonal) components of the local inertia tensor in the body's local coordinates.
setJointErp(float) - Method in class com.jme3.bullet.SolverInfo
Alter the error-reduction parameter for non-contact constraints (native field: m_erp).
setJointPosition(int, float) - Method in class com.jme3.bullet.MultiBodyLink
Alter the position of the indexed DOF.
setJointVelocity(int, float) - Method in class com.jme3.bullet.MultiBodyLink
Alter the velocity of the indexed DOF.
setJumpSpeed(float) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's jump speed.
setJumpSpeed(float) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's jump speed.
setKinematic(boolean) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Put the body into kinematic mode or take it out of kinematic mode.
setLateralFrictionDir1(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the lateral friction direction #1 of the specified point (native field: m_lateralFrictionDir1).
setLateralFrictionDir2(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the lateral friction direction #2 of the specified point (native field: m_lateralFrictionDir2).
setLimit(float, float) - Method in class com.jme3.bullet.joints.HingeJoint
Alter the angular limits for this joint.
setLimit(float, float, float) - Method in class com.jme3.bullet.joints.ConeJoint
Alter the angular limits for this joint.
setLimit(float, float, float, float, float) - Method in class com.jme3.bullet.joints.HingeJoint
Alter the angular limits for this joint.
setLimitSoftness(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's limit softness (native field: m_limitSoftness).
setLimitSoftness(float) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter the limit softness (native field: m_limitSoftness).
setLinearDamping(float) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's linear damping.
setLinearDamping(float) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's linear damping.
setLinearDamping(float) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's linear damping.
setLinearFactor(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's linear factors.
setLinearLowerLimit(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Alter the joint's lower limits for translation of all 3 axes.
setLinearSleepingThreshold(float) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's linear-motion sleeping threshold.
setLinearStiffness(float) - Method in class com.jme3.bullet.objects.infos.SoftBodyMaterial
Alter the linear-stiffness coefficient (native field: m_kLST).
setLinearUpperLimit(Vector3f) - Method in class com.jme3.bullet.joints.SixDofJoint
Alter the joint's upper limits for translation of all 3 axes.
setLinearVelocity(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the linear velocity of the character's center.
setLinearVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter the linear velocity of this character's center.
setLinearVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the linear velocity of the body's center of mass.
setLinearVelocity(Vector3f) - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Alter the rigid velocity.
setLinearVelocityDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the linear velocity of the body's center of mass.
setListSeparator(String) - Method in class jme3utilities.debug.Describer
Alter the list separator.
setLocalPointA(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the location of the specified point in the local coordinates of object A (native name: m_localPointA).
setLocalPointB(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the location of the specified point in the local coordinates of object B (native name: m_localPointB).
setLocalThreadPhysicsSpace(CollisionSpace) - Static method in class com.jme3.bullet.CollisionSpace
Alter the CollisionSpace associated with this thread.
setLocation(Vector3f) - Method in class com.jme3.bullet.joints.SoftLinearJoint
Alter the joint location.
setLocationAndBasis(Vector3f, Matrix3f) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Directly alter the collision object's location and basis.
setLowerAngLimit(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's lower limit for on-axis rotation.
setLowerLimit(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's constraint lower limit (native field: m_loLimit).
setLowerLimit(float) - Method in class com.jme3.bullet.joints.NewHinge
Alter the lower limit for axis1 rotation.
setLowerLimit(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's constraint lower limits (native field: m_lowerLimit).
setLowerLinLimit(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's lower limit for on-axis translation.
setMargin(float) - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Alter the collision margin of the shape.
setMargin(float) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Alter the collision margin of this shape.
setMargin(float) - Method in class com.jme3.bullet.collision.shapes.MinkowskiSum
Alter the collision margin of this shape.
setMargin(float) - Method in class com.jme3.bullet.collision.shapes.SphereCollisionShape
Alter the collision margin of this shape.
setMargin(float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the collision margin of this body.
setMass(float) - Method in class com.jme3.bullet.objects.PhysicsBody
Alter this body's total mass.
setMass(float) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's mass.
setMass(float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the total mass for this body, distributing it in proportion to the current mass of each node.
setMassByArea(float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the total mass for this body, distributing it based on the area of each face.
setMassByCurrent(float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the total mass for this body, distributing it to nodes in proportion to their current masses.
setMasses(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the masses of all nodes.
setMassFromDensity(float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the total mass of this body, weighted by volume.
setMaxAngMotorForce(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the maximum force of the rotation motor.
setMaxConcavity(double) - Method in class vhacd.VHACDParameters
Set maximum concavity (native field: m_concavity).
setMaxDisplacement(float) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Alter the maximum distance a node can travel per simulation step.
setMaxHulls(int) - Method in class vhacd4.Vhacd4Parameters
Alter the maximum number of convex hulls (native field: m_maxConvexHulls).
setMaxLimitForce(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter the limit maximum force (native field: m_maxLimitForce).
setMaxLinMotorForce(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the maximum force of the translation motor.
setMaxMotorForce(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's maximum force (native field: m_maxMotorForce).
setMaxMotorForce(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's maximum forces (native field: m_maxMotorForce).
setMaxPenetrationDepth(float) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's maximum penetration depth.
setMaxPenetrationDepth(float) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's maximum penetration depth.
setMaxRecursion(int) - Method in class vhacd4.Vhacd4Parameters
Alter the maximum recursion depth (native field: m_maxRecursionDepth).
setMaxSlope(float) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's maximum slope angle.
setMaxSlope(float) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's maximum slope angle.
setMaxSubSteps(int) - Method in class com.jme3.bullet.PhysicsSpace
Alter the maximum number of simulation steps per frame.
setMaxSuspensionForce(float) - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Alter the force exerted by each wheel's suspension (native field: m_maxSuspensionForce).
setMaxSuspensionForce(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the initial maximum suspension force for new wheels.
setMaxSuspensionForce(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter the maximum force exerted by this wheel's suspension (native field: m_maxSuspensionForce).
setMaxSuspensionForce(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the maximum suspension force for the specified wheel.
setMaxSuspensionTravelCm(float) - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Alter the maximum travel distance for the suspension (native field: m_maxSuspensionTravelCm).
setMaxSuspensionTravelCm(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the initial maximum suspension travel distance for new wheels.
setMaxSuspensionTravelCm(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter the maximum travel distance for this wheel's suspension (native field: m_maxSuspensionTravelCm).
setMaxSuspensionTravelCm(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the maximum suspension travel distance for the indexed wheel.
setMaxTimeStep(float) - Method in class com.jme3.bullet.PhysicsSpace
Alter the maximum time step (imposed when maxSubSteps=0).
setMaxVerticesPerHull(int) - Method in class vhacd.VHACDParameters
Alter the maximum number of vertices per convex hull (native field: m_maxNumVerticesPerCH).
setMaxVerticesPerHull(int) - Method in class vhacd4.Vhacd4Parameters
Alter the maximum number of vertices per convex hull (native field: m_maxNumVerticesPerCH).
setMinBatch(int) - Method in class com.jme3.bullet.SolverInfo
Alter the minimum batch size (native field: m_minimumSolverBatchSize).
setMinEdgeLength(int) - Method in class vhacd4.Vhacd4Parameters
Alter the minimum edge length (native field: m_minEdgeLength).
setMinMax(Vector3f, Vector3f) - Method in class com.jme3.bounding.BoundingBox
Reconfigure with the specified extremes.
setMinVolumePerHull(double) - Method in class vhacd.VHACDParameters
Set the minimum volume to add vertices to convex hulls (native field: m_minVolumePerCH).
setMode(int) - Method in class com.jme3.bullet.SolverInfo
Alter the mode flags (native field: m_solverMode).
setMotorEnabled(boolean) - Method in class com.jme3.bullet.joints.motors.RotationMotor
Enable or disable this motor (native field: m_enableMotor).
setMotorEnabled(int, boolean) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Enable or disable the indexed axis (m_enableMotor).
setNativeId(long) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Initialize the native ID.
setNativeId(long) - Method in class com.jme3.bullet.joints.PhysicsJoint
Initialize the native ID.
setNativeId(long) - Method in class com.jme3.bullet.NativePhysicsObject
Assign a tracked native object to this instance, assuming that no native object is assigned.
setNativeIdNotTracked(long) - Method in class com.jme3.bullet.NativePhysicsObject
Assign an untracked native object to this instance, assuming that no native object is assigned.
setNodeMass(int, float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the mass of the indexed node.
setNodeVelocity(int, Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the velocity of the indexed node.
setNormalCFM(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's constraint-force mixing parameter for normal conditions (native field: m_normalCFM).
setNormalCFM(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's constraint-force mixing parameters for normal conditions (native field: m_normalCFM).
setNormals(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the normal vectors of all nodes.
setNormalsModified() - Method in interface jme3utilities.lbj.Mesh
Indicate that the normals data buffer is dirty.
setNormalWorldOnB(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the normal on object B of the specified point in physics-space coordinates (native name: m_normalWorldOnB).
setNumIterations(int) - Method in class com.jme3.bullet.SolverInfo
Alter the number of iterations (native field: m_numIterations).
setPCA(boolean) - Method in class vhacd.VHACDParameters
Enable/disable normalizing the mesh before applying the convex decomposition (native field: m_pca).
setPhysicsLocation(Vector3f) - Method in class com.jme3.bullet.objects.MultiBodyCollider
Directly alter the location of this collider's center.
setPhysicsLocation(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsBody
Directly relocate this body's center.
setPhysicsLocation(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Directly alter this character's location.
setPhysicsLocation(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Directly alter the location of the ghost's center.
setPhysicsLocation(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Directly relocate the body's center of mass.
setPhysicsLocation(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Directly relocate the center of this body's bounding box.
setPhysicsLocationDp(Vec3d) - Method in class com.jme3.bullet.objects.MultiBodyCollider
Directly alter the location of this collider's center.
setPhysicsLocationDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Directly alter this character's location.
setPhysicsLocationDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Directly alter the location of the ghost's center.
setPhysicsLocationDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Directly relocate the body's center of mass.
setPhysicsLocationDp(Vec3d) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Directly relocate the center of this body's bounding box.
setPhysicsRotation(Matrix3f) - Method in class com.jme3.bullet.objects.MultiBodyCollider
Directly alter this collider's orientation.
setPhysicsRotation(Matrix3f) - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Directly alter the ghost's orientation.
setPhysicsRotation(Matrix3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Directly alter the body's orientation.
setPhysicsRotation(Quaternion) - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Directly alter the ghost's orientation.
setPhysicsRotation(Quaternion) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Directly reorient the body.
setPhysicsRotationDp(Matrix3d) - Method in class com.jme3.bullet.objects.MultiBodyCollider
Directly alter this collider's orientation.
setPhysicsRotationDp(Matrix3d) - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Directly alter the ghost's orientation.
setPhysicsRotationDp(Matrix3d) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Directly reorient the body.
setPhysicsRotationDp(Quatd) - Method in class com.jme3.bullet.objects.PhysicsGhostObject
Directly alter the ghost's orientation.
setPhysicsRotationDp(Quatd) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Directly reorient the body.
setPhysicsScale(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Rescale the body.
setPhysicsSpace(PhysicsSpace) - Method in class com.jme3.bullet.joints.PhysicsJoint
Alter which PhysicsSpace this joint is added to.
setPhysicsTransform(Transform) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Directly alter the body's transform, including the scale of its shape.
setPivotInA(Vector3f) - Method in class com.jme3.bullet.joints.Constraint
Alter the pivot location in A's scaled local coordinates.
setPivotInA(Vector3f) - Method in class com.jme3.bullet.joints.New6Dof
Alter the pivot location in A's scaled local coordinates.
setPivotInA(Vector3f) - Method in class com.jme3.bullet.joints.Point2PointJoint
Alter the pivot location in A's scaled local coordinates.
setPivotInB(Vector3f) - Method in class com.jme3.bullet.joints.Anchor
Alter the pivot location in B's local coordinates.
setPivotInB(Vector3f) - Method in class com.jme3.bullet.joints.Constraint
Alter the pivot location in B's scaled local coordinates.
setPivotInB(Vector3f) - Method in class com.jme3.bullet.joints.New6Dof
Alter the pivot location in B's scaled local coordinates.
setPivotInB(Vector3f) - Method in class com.jme3.bullet.joints.Point2PointJoint
Alter the pivot location in B's scaled local coordinates.
setPlaneDownSampling(int) - Method in class vhacd.VHACDParameters
Set granularity of the search for the "best" clipping plane (native field: m_planeDownsampling).
setPose(boolean, boolean) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Set the "default pose" (lowest energy state) of this body based on its current pose.
setPositionIterations(int) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Alter the number of position-solver iterations (native field: piterations).
setPositionsModified() - Method in interface jme3utilities.lbj.Mesh
Indicate that the positions data buffer is dirty.
setPositionWorldOnA(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the location of the specified point on object A in physics-space coordinates (native field: m_positionWorldOnA).
setPositionWorldOnB(long, Vector3f) - Static method in class com.jme3.bullet.collision.ManifoldPoints
Alter the location of the specified point on object B in physics-space coordinates (native field: m_positionWorldOnB).
setPoweredAngMotor(boolean) - Method in class com.jme3.bullet.joints.SliderJoint
Alter whether the rotation motor is powered.
setPoweredLinMotor(boolean) - Method in class com.jme3.bullet.joints.SliderJoint
Alter whether the translation motor is powered.
setProtectGravity(boolean) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter whether the body's gravity should be overwritten if the body gets added to a PhysicsSpace or the gravity of the PhysicsSpace changes.
setProtectWorldInfo(boolean) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter whether this body's world info should be replaced when the body gets added to a space.
setRadius(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter the radius of this wheel (native field: m_wheelsRadius).
setRatio(float) - Method in class com.jme3.bullet.joints.GearJoint
Alter the joint's gear ratio.
setRayTestFlags(int) - Method in class com.jme3.bullet.CollisionSpace
Alter the flags used in ray tests (native field: m_flags).
setReducedModes(int, int) - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Alter the number of modes.
setReducedModesEnabled(boolean) - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Enable/disable reduced modes.
setReinitializationCallbackEnabled(boolean) - Static method in class com.jme3.bullet.util.NativeLibrary
Alter whether the native library should invoke the reinitialization() callback.
setRestingLengthScale(float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the scale factor for resting lengths.
setRestitution(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the collision object's restitution (bounciness) (native field: m_restitution).
setRestitution(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's restitution at the limits (native field: m_bounce).
setRestitution(float) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's restitution at the limits (native field: m_restitution).
setRestitutionDirAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's restitution for on-axis rotation between the limits.
setRestitutionDirLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's restitution for on-axis translation between the limits.
setRestitutionLimAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's restitution for on-axis rotation hitting the limits.
setRestitutionLimLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's restitution for on-axis translation hitting the limits.
setRestitutionOrthoAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's restitution for off-axis rotation.
setRestitutionOrthoLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's restitution for off-axis translation.
setRestLength(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter the rest length of the suspension of this wheel (native field: m_suspensionRestLength1).
setRollInfluence(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter this wheel's roll influence (native field: m_rollInfluence).
setRollInfluence(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the roll influence of the indexed wheel.
setRollingFriction(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter this object's rolling friction: torsional friction orthogonal to the contact normal (native field: m_rollingFriction).
setRotation(Quaternion) - Method in class com.jme3.math.Transform
Sets the rotation component to the argument.
setRotation(Quatd) - Method in class com.jme3.math.TransformDp
Sets the rotation component to the argument.
setRotationAngle(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter the total rotation of this wheel (native field: m_rotation).
setRotationOrder(RotationOrder) - Method in class com.jme3.bullet.joints.New6Dof
Alter the order in which to apply axis rotations.
setScale(double) - Method in class com.jme3.math.TransformDp
Sets all components of the scaling component to the argument.
setScale(float) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Alter the scale of this shape to a uniform factor.
setScale(float) - Method in class com.jme3.math.Transform
Sets the scaling component to the argument.
setScale(float, float, float) - Method in class com.jme3.math.Matrix4f
Alters the scale component of the coordinate transform.
setScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Alter the scale of this shape.
setScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Alter the scale of this shape and its children.
setScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.Convex2dShape
Alter the scale of this shape and its base.
setScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Alter the scale factors of this shape.
setScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Alter the scale factors.
setScale(Vector3f) - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Alter the scale of this shape.
setScale(Vector3f) - Method in class com.jme3.math.Matrix4f
Alters the scale component of the coordinate transform.
setScale(Vector3f) - Method in class com.jme3.math.Transform
Sets the scaling component to the argument.
setScale(Vec3d) - Method in class com.jme3.math.TransformDp
Sets the scaling component to the argument.
setScaledInertia(float, float, float) - Method in class com.jme3.bullet.collision.shapes.CustomConvexShape
Alter the scaled rotational inertia.
setServoEnabled(boolean) - Method in class com.jme3.bullet.joints.motors.RotationMotor
Enable or disable the servo (native field: m_servoMotor).
setServoEnabled(int, boolean) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Enable or disable the indexed servo (m_servoMotor).
setShrinkWrap(boolean) - Method in class vhacd4.Vhacd4Parameters
Alter whether to shrinkwrap voxel positions to the source mesh (native field: m_shrinkWrap).
setSleepingThresholds(float, float) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Alter the body's sleeping thresholds.
setSoftnessDirAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's softness for on-axis rotation between the limits.
setSoftnessDirLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's softness for on-axis translation between the limits.
setSoftnessLimAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's softness for on-axis rotation hitting the limits.
setSoftnessLimLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's softness for on-axis translation hitting the limits.
setSoftnessOrthoAng(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's softness for off-axis rotation.
setSoftnessOrthoLin(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's softness for off-axis translation.
setSpinningFriction(float) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter this object's spinning friction: torsional friction around the contact normal (native field: m_spinningFriction).
setSplit(float) - Method in class com.jme3.bullet.joints.SoftPhysicsJoint
Alter the split.
setSplitImpulseEnabled(boolean) - Method in class com.jme3.bullet.SolverInfo
Alter whether split impulse is enabled globally (native field: m_splitImpulse).
setSplitImpulseErp(float) - Method in class com.jme3.bullet.SolverInfo
Alter the error-reduction parameter (ERP) used with split impulse (native field: m_splitImpulseTurnErp).
setSplitImpulseThreshold(float) - Method in class com.jme3.bullet.SolverInfo
Alter the degree of penetration at which split impulse will be used.
setSpringEnabled(boolean) - Method in class com.jme3.bullet.joints.motors.RotationMotor
Enable or disable the spring (native field: m_enableSpring).
setSpringEnabled(int, boolean) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Enable or disable the indexed spring (m_enableSpring).
setStartupMessageEnabled(boolean) - Static method in class com.jme3.bullet.util.NativeLibrary
Alter whether the native library will print its startup message during initialization.
setStepHeight(float) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's step height.
setStepHeight(float) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's step height.
setStiffness(int, float) - Method in class com.jme3.bullet.joints.SixDofSpringJoint
Alter the spring stiffness for the indexed degree of freedom.
setStiffness(int, float, boolean) - Method in class com.jme3.bullet.joints.New6Dof
Alter the spring stiffness for the indexed degree of freedom.
setStiffnessLimited(boolean) - Method in class com.jme3.bullet.joints.motors.RotationMotor
Limit or unlimit the spring's stiffness (native field: m_springStiffnessLimited).
setStiffnessLimited(int, boolean) - Method in class com.jme3.bullet.joints.motors.TranslationMotor
Limit or unlimit the stiffness of the indexed spring (m_springStiffnessLimited).
setStiffnessScale(float) - Method in class com.jme3.bullet.objects.ReducedDeformableBody
Alter the stiffness scale.
setStopCFM(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's constraint-force mixing parameter at the limits (native field: m_stopCFM).
setStopCFM(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's constraint-force mixing parameters at the limits (native field: m_stopCFM).
setSuspensionCompression(float) - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Alter the suspension damping when compressed (native field: m_suspensionCompression).
setSuspensionCompression(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the initial damping (when the suspension is compressed) for new wheels.
setSuspensionCompression(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the damping (when the suspension is compressed) for the indexed wheel.
setSuspensionDamping(float) - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Alter the suspension damping when expanded (native field: m_suspensionDamping).
setSuspensionDamping(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the initial damping (when the suspension is expanded) for new wheels.
setSuspensionDamping(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the damping (when the suspension is expanded) for the indexed wheel.
setSuspensionLength(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter the length of this wheel's suspension (native field: m_suspensionLength).
setSuspensionStiffness(float) - Method in class com.jme3.bullet.objects.infos.VehicleTuning
Alter the stiffness of the suspension (native field: m_suspensionStiffness).
setSuspensionStiffness(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the initial suspension stiffness for new wheels.
setSuspensionStiffness(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter the stiffness of this wheel's suspension (native field: m_suspensionStiffness).
setSuspensionStiffness(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the suspension stiffness of the indexed wheel.
setSweepTest(boolean) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter which convex-sweep test is used.
setSweepTest(boolean) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter which convex-sweep test is used.
setTargetAngMotorVelocity(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the velocity target of the rotation motor.
setTargetLinMotorVelocity(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the velocity target of the translation motor.
setTargetVelocity(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's target velocity (native field: m_targetVelocity).
setTargetVelocity(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's target velocity (native field: m_targetVelocity).
setTau(float) - Method in class com.jme3.bullet.joints.Point2PointJoint
Alter the joint's tau value.
setTransform(Vector3f, Matrix3f) - Method in class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Alter the child's coordinate transform copy.
setTranslation(Vector3f) - Method in class com.jme3.math.Matrix4f
Alters the translation component of the coordinate transform.
setTranslation(Vector3f) - Method in class com.jme3.math.Transform
Sets the translation component to the argument.
setTranslation(Vec3d) - Method in class com.jme3.math.TransformDp
Sets the translation component to the argument.
setTraversalMode(int) - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Alter the traversal mode (native field: m_traversalMode).
setUp(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's "up" direction.
setUp(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's "up" direction.
setUpperAngLimit(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's upper limit for on-axis rotation.
setUpperLimit(float) - Method in class com.jme3.bullet.joints.motors.RotationalLimitMotor
Alter this motor's constraint upper limit (native field: m_hiLimit).
setUpperLimit(float) - Method in class com.jme3.bullet.joints.NewHinge
Alter the upper limit for axis1 rotation.
setUpperLimit(Vector3f) - Method in class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Alter this motor's constraint upper limits (native field: m_upperLimit).
setUpperLinLimit(float) - Method in class com.jme3.bullet.joints.SliderJoint
Alter the joint's upper limit for on-axis translation.
setUserIndex(int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the collision object's primary user index.
setUserIndex(int) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Alter the primary user index.
setUserIndex(int) - Method in class com.jme3.bullet.MultiBody
Alter the primary user index.
setUserIndex2(int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the collision object's secondary user index.
setUserIndex2(int) - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Alter the secondary user index.
setUserIndex2(int) - Method in class com.jme3.bullet.MultiBody
Alter the secondary user index.
setUserIndex3(int) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Alter the collision object's tertiary user index.
setUserObject(Object) - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Associate a "user" with the collision object.
setVehicle(PhysicsVehicle) - Method in class com.jme3.bullet.objects.infos.RigidBodyMotionState
Alter which vehicle uses this motion state.
setVehicleId(long, int) - Method in class com.jme3.bullet.objects.VehicleWheel
Assign this wheel to a vehicle.
setVelocities(FloatBuffer) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the velocities of all nodes.
setVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the velocities of all nodes to make them identical.
setVelocityIterations(int) - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Alter the number of velocity-solver iterations (native field: viterations).
setVolumeDensity(float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Set volume density (using tetrahedra) TODO clarify semantics
setVolumeMass(float) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Set volume mass (using tetrahedra) TODO clarify semantics
setVolumePercentError(double) - Method in class vhacd4.Vhacd4Parameters
Alter the tolerance for the percent difference between the voxel volume and the volume of the hull (native field: m_minimumVolumePercentErrorAllowed).
setVolumeStiffness(float) - Method in class com.jme3.bullet.objects.infos.SoftBodyMaterial
Alter the volume-stiffness coefficient (native field: m_kVST).
setVoxelResolution(int) - Method in class vhacd.VHACDParameters
Alter the maximum number of voxels generated during the voxelization stage (native field: m_resolution).
setVoxelResolution(int) - Method in class vhacd4.Vhacd4Parameters
Alter the maximum number of voxels generated during the voxelization stage (native field: m_resolution).
setWalkDirection(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Alter the character's walk offset.
setWalkDirection(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Alter this character's walk offset.
setWaterDensity(float) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Alter the water density.
setWaterNormal(Vector3f) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Alter the water normal.
setWaterOffset(float) - Method in class com.jme3.bullet.SoftBodyWorldInfo
Alter the water offset.
setWheelsDampingCompression(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter this wheel's damping when the suspension is compressed (native field: m_wheelsDampingCompression).
setWheelsDampingRelaxation(float) - Method in class com.jme3.bullet.objects.VehicleWheel
Alter this wheel's damping when the suspension is expanded (native field: m_wheelsDampingRelaxation).
setWindVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Alter the wind velocity.
setWorldInfo(SoftBodyWorldInfo) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Replace the world info of this body.
setWorldInfoInternal(SoftBodyWorldInfo) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Replace the world-dependent info.
setXExtent(float) - Method in class com.jme3.bounding.BoundingBox
Alter the X-axis distance between the center and the boundary.
setYExtent(float) - Method in class com.jme3.bounding.BoundingBox
Alter the Y-axis distance between the center and the boundary.
setZExtent(float) - Method in class com.jme3.bounding.BoundingBox
Alter the Z-axis distance between the center and the boundary.
SI - Enum constant in enum class com.jme3.bullet.SolverType
btSequentialImpulseConstraintSolver/btMultiBodyConstraintSolver: Bullet's original sequential-impulse solver
SIMD - Static variable in class com.jme3.bullet.SolverMode
SIMD
SIMPLE - Enum constant in enum class com.jme3.bullet.PhysicsSpace.BroadphaseType
btSimpleBroadphase: a brute-force reference implementation for debugging purposes
SimplexCollisionShape - Class in com.jme3.bullet.collision.shapes
A simple point, line-segment, triangle, or tetrahedron collision shape based on Bullet's btBU_Simplex1to4.
SimplexCollisionShape(Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Instantiate a point shape based on the specified location.
SimplexCollisionShape(Vector3f[]) - Constructor for class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Instantiate a simplex shape based on the specified array.
SimplexCollisionShape(Vector3f, Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Instantiate a line-segment shape based on the specified endpoints.
SimplexCollisionShape(Vector3f, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Instantiate a triangular shape based on the specified vertices.
SimplexCollisionShape(Vector3f, Vector3f, Vector3f, Vector3f) - Constructor for class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Instantiate a tetrahedral shape based on the specified vertices.
SimplexCollisionShape(FloatBuffer, int, int) - Constructor for class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Instantiate a simplex shape based on the specified FloatBuffer range.
sin(float) - Static method in class com.jme3.math.FastMath
Returns the sine of an angle.
SixDofJoint - Class in com.jme3.bullet.joints
A 6 degree-of-freedom joint based on Bullet's btGeneric6DofConstraint.
SixDofJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, boolean) - Constructor for class com.jme3.bullet.joints.SixDofJoint
Instantiate a double-ended SixDofJoint.
SixDofJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, Matrix3f, Matrix3f, boolean) - Constructor for class com.jme3.bullet.joints.SixDofJoint
Instantiate a double-ended SixDofJoint.
SixDofJoint(PhysicsRigidBody, Vector3f, Vector3f, Matrix3f, Matrix3f, JointEnd) - Constructor for class com.jme3.bullet.joints.SixDofJoint
Instantiate a single-ended SixDofJoint.
SixDofSpringJoint - Class in com.jme3.bullet.joints
A 6 degree-of-freedom joint based on Bullet's btGeneric6DofSpringConstraint.
SixDofSpringJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, Matrix3f, Matrix3f, boolean) - Constructor for class com.jme3.bullet.joints.SixDofSpringJoint
Instantiate a double-ended SixDofSpringJoint.
SixDofSpringJoint(PhysicsRigidBody, Vector3f, Vector3f, Matrix3f, Matrix3f, JointEnd) - Constructor for class com.jme3.bullet.joints.SixDofSpringJoint
Instantiate a single-ended SixDofSpringJoint.
size() - Method in class jme3utilities.lbj.IndexBuffer
Return the buffer's limit.
sleeping - Static variable in class com.jme3.bullet.collision.Activation
a deactivated collision object (native name: ISLAND_SLEEPING)
slerp(float, Quaternion, Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Interpolate between 2 normalized quaternions using spherical linear (Slerp) interpolation.
SliderJoint - Class in com.jme3.bullet.joints
A 2 degree-of-freedom joint based on Bullet's btSliderConstraint.
SliderJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, boolean) - Constructor for class com.jme3.bullet.joints.SliderJoint
Instantiate a double-ended SliderJoint.
SliderJoint(PhysicsRigidBody, PhysicsRigidBody, Vector3f, Vector3f, Matrix3f, Matrix3f, boolean) - Constructor for class com.jme3.bullet.joints.SliderJoint
Instantiate a double-ended SliderJoint.
SliderJoint(PhysicsRigidBody, Vector3f, Vector3f, JointEnd) - Constructor for class com.jme3.bullet.joints.SliderJoint
Instantiate a single-ended SliderJoint.
smaller() - Method in class jme3utilities.math.IntPair
Read the smaller element of the pair.
soft - Static variable in class com.jme3.bullet.collision.PcoType
value for a PhysicsSoftBody (native name: CO_SOFT_BODY)
SoftAngularJoint - Class in com.jme3.bullet.joints
A SoftPhysicsJoint that allows rotation around an axis, based on Bullet's btSoftBody::AJoint.
SoftAngularJoint(Vector3f, PhysicsSoftBody, int, PhysicsRigidBody) - Constructor for class com.jme3.bullet.joints.SoftAngularJoint
Instantiate a soft-rigid angular joint.
SoftAngularJoint(Vector3f, PhysicsSoftBody, int, PhysicsSoftBody, int) - Constructor for class com.jme3.bullet.joints.SoftAngularJoint
Instantiate a soft-soft angular joint.
SoftBodyConfig - Class in com.jme3.bullet.objects.infos
Provide access to fields of the native btSoftBody::Config struct.
SoftBodyConfig(PhysicsSoftBody) - Constructor for class com.jme3.bullet.objects.infos.SoftBodyConfig
Instantiate a config with the default properties.
SoftBodyMaterial - Class in com.jme3.bullet.objects.infos
Provide access to 3 fields of the native btSoftBody::Material struct.
SoftBodyMaterial(PhysicsSoftBody) - Constructor for class com.jme3.bullet.objects.infos.SoftBodyMaterial
Instantiate a material with the default properties.
SoftBodyWorldInfo - Class in com.jme3.bullet
Physics-simulation parameters that can be customized for each PhysicsSoftBody, based on Bullet's btSoftBodyWorldInfo.
SoftBodyWorldInfo() - Constructor for class com.jme3.bullet.SoftBodyWorldInfo
Instantiate an info that refers to a new btSoftBodyWorldInfo with the default parameters.
SoftBodyWorldInfo(long) - Constructor for class com.jme3.bullet.SoftBodyWorldInfo
Instantiate an info that refers to the identified native object.
SoftHardness - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
soft-body contact hardness coefficient (≥0, ≤1, default=1, native field: kSHR)
SoftLinearJoint - Class in com.jme3.bullet.joints
A SoftPhysicsJoint based on Bullet's btSoftBody::LJoint.
SoftLinearJoint(Vector3f, PhysicsSoftBody, int, PhysicsRigidBody) - Constructor for class com.jme3.bullet.joints.SoftLinearJoint
Instantiate a soft-rigid linear joint.
SoftLinearJoint(Vector3f, PhysicsSoftBody, int, PhysicsSoftBody, int) - Constructor for class com.jme3.bullet.joints.SoftLinearJoint
Instantiate a soft-soft linear joint.
SoftPhysicsJoint - Class in com.jme3.bullet.joints
The abstract base class for joining a PhysicsSoftBody to another body, based on Bullet's btSoftBody::Joint.
SoftPhysicsJoint(PhysicsSoftBody, int, PhysicsRigidBody) - Constructor for class com.jme3.bullet.joints.SoftPhysicsJoint
Instantiate a SoftPhysicsJoint to join a soft-body cluster and a rigid body.
SoftPhysicsJoint(PhysicsSoftBody, int, PhysicsSoftBody, int) - Constructor for class com.jme3.bullet.joints.SoftPhysicsJoint
Instantiate a SoftPhysicsJoint to join 2 soft bodies.
SolverInfo - Class in com.jme3.bullet
Parameters used by the contact-and-constraint solver, based on Bullet's btContactSolverInfo.
SolverMode - Class in com.jme3.bullet
Named mode bits for contact-and-constraint solvers, based on btSolverMode.
SolverType - Enum Class in com.jme3.bullet
Enumerate the available contact-and-constraint solvers.
spaceId() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the ID of the space where the collision object is added.
spaceId() - Method in class com.jme3.bullet.MultiBody
Determine the ID of the MultiBodySpace to which this MultiBody is added.
SphereCollisionShape - Class in com.jme3.bullet.collision.shapes
A spherical collision shape based on Bullet's btSphereShape.
SphereCollisionShape(float) - Constructor for class com.jme3.bullet.collision.shapes.SphereCollisionShape
Instantiate a sphere shape with the specified radius.
SphereCollisionShape(FloatBuffer, int, int) - Constructor for class com.jme3.bullet.collision.shapes.SphereCollisionShape
Instantiate a sphere shape that encloses the sample locations in the specified FloatBuffer range.
sphereRadius() - Method in class com.jme3.bullet.collision.shapes.SphericalSegment
Return the radius of the parent sphere.
sphereVolume(float) - Static method in class jme3utilities.math.MyVolume
Compute the volume of a sphere with the specified radius.
Spherical - Enum constant in enum class com.jme3.bullet.MultiBodyJointType
spherical joint (native name: eSpherical)
SphericalSegment - Class in com.jme3.bullet.collision.shapes
A collision shape for a spherical segment with uniform density, based on btConvexInternalShape.
SphericalSegment(float) - Constructor for class com.jme3.bullet.collision.shapes.SphericalSegment
Instantiate a hemisphere with the specified radius.
SphericalSegment(float, float, float) - Constructor for class com.jme3.bullet.collision.shapes.SphericalSegment
Instantiate a spherical segment with the specified dimensions.
split(Plane) - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Attempt to divide this mesh into 2 meshes.
split(Triangle) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Divide this shape into 2 compound shapes.
split(Triangle) - Method in class com.jme3.bullet.collision.shapes.GImpactCollisionShape
Attempt to divide this shape into 2 shapes.
split(Triangle) - Method in class com.jme3.bullet.collision.shapes.HullCollisionShape
Attempt to divide this shape into 2 child shapes.
split(Triangle) - Method in class com.jme3.bullet.collision.shapes.infos.ChildCollisionShape
Attempt to divide this child into 2 children.
split(Triangle) - Method in class com.jme3.bullet.collision.shapes.infos.CompoundMesh
Attempt to divide this mesh into 2 meshes.
split(Triangle) - Method in class com.jme3.bullet.collision.shapes.MeshCollisionShape
Attempt to divide this shape into 2 shapes.
splitImpulseErp() - Method in class com.jme3.bullet.SolverInfo
Determine the error-reduction parameter (ERP) used with split impulse (native field: m_splitImpulseTurnErp).
splitImpulseThreshold() - Method in class com.jme3.bullet.SolverInfo
Determine the minimum degree of penetration at which split impulse would be used, assuming it's not enabled globally (native field: m_splitImpulsePenetrationThreshold).
sqrt(float) - Static method in class com.jme3.math.FastMath
Returns the square root of a given value.
squad(float, Quaternion, Quaternion, Quaternion, Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Interpolate between 4 normalized quaternions using the Squad function.
squadA(Quaternion, Quaternion, Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Return Squad parameter "a" for a continuous first derivative at the middle point of 3 specified control points.
standardAngle(float, String) - Static method in class jme3utilities.Validate
Validate a standardized angle as a method argument.
standardize(float) - Static method in class jme3utilities.math.MyMath
Standardize a single-precision value in preparation for hashing.
standardize(Quaternion, Quaternion) - Static method in class jme3utilities.math.MyQuaternion
Standardize a Quaternion in preparation for hashing.
standardize(Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVector3f
Standardize a vector in preparation for hashing.
standardizeAngle(float) - Static method in class jme3utilities.math.MyMath
Standardize a rotation angle to the range [-Pi, Pi).
STATIC_OBJECT - Static variable in class com.jme3.bullet.collision.CollisionFlag
flag for a static object
steer(float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the steering angle of all front wheels.
steer(int, float) - Method in class com.jme3.bullet.objects.PhysicsVehicle
Alter the steering angle of the indexed wheel.
steer(VehicleWheel, float) - Method in class com.jme3.bullet.objects.infos.VehicleController
Alter the steering angle of the specified wheel.
Stiffness - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
spring's stiffness (m_springStiffness, default=0)
StopCfm - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
constraint-force mixing parameter at limits (m_stopCFM, native name: BT_CONSTRAINT_STOP_CFM, default=0)
StopErp - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
error-reduction parameter at limits (m_stopERP, native name: BT_CONSTRAINT_STOP_ERP, default=0.2)
stream - Variable in class jme3utilities.debug.Dumper
stream to use for output: set by constructor
SubSimplexRaytest - Static variable in class com.jme3.bullet.RayTestFlag
use the fast/approximate algorithm for ray-versus-convex intersection, which is the default if no flags are set (native value: kF_UseSubSimplexConvexCastRaytest)
subtract(float, float, float) - Method in class com.jme3.math.Vector3f
Subtracts the specified amounts from the vector's components and returns the difference as a new instance.
subtract(Vector3f) - Method in class com.jme3.math.Vector3f
Subtracts the argument and returns the difference as a new instance.
subtract(Vector3f, Vector3f) - Method in class com.jme3.math.Vector3f
Subtracts the specified vector and returns the difference in a 3rd vector.
subtract(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Subtracts the argument and returns the difference as a new instance.
subtractLocal(float, float, float) - Method in class com.jme3.math.Vector3f
Subtracts the specified amounts from the vector's components and returns the (modified) current instance.
subtractLocal(Vector3f) - Method in class com.jme3.math.Vector3f
Subtracts the argument and returns the (modified) current instance.
subtractLocal(Vec3d) - Method in class com.simsilica.mathd.Vec3d
Subtracts the argument and returns the (modified) current instance.
sumOfSquares(float...) - Static method in class jme3utilities.math.MyMath
Return the sum of squares of some single-precision values.
surfaceArea() - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Calculate the (one-sided) surface area of the mesh.
SurfaceOnly - Enum constant in enum class com.jme3.bullet.FillMode
create a hollow skin (native name: SURFACE_ONLY)
sweepTest(ConvexShape, Transform, Transform, List<PhysicsSweepTestResult>, float) - Method in class com.jme3.bullet.CollisionSpace
Perform a sweep-collision test and store the results in an existing list, in arbitrary order.

T

tan(float) - Static method in class com.jme3.math.FastMath
Returns the tangent of the specified angle.
TargetVelocity - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
motor's target velocity (m_targetVelocity, default=0)
TempVars - Class in com.jme3.util
Temporary variables assigned to each thread.
TestApp - Class in jme3utilities.minie
Command-line application for testing Libbulletjme.
TETRAHEDRON - Enum constant in enum class vhacd.ACDMode
m_mode = 1: use tetrahedra
tetrahedronVolume(Vector3f, Vector3f, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyVolume
Determine the volume of the specified tetrahedron.
threadTmpVector - Static variable in class com.jme3.bullet.collision.shapes.CustomConvexShape
temporary storage for one vector per thread
throwNpe - Static variable in class jme3utilities.Validate
If true, throw NullPointerException for null arguments.
TimeScale - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
time scale (default=1, native field: timescale)
toBuffer() - Method in interface jme3utilities.math.VectorSet
Access a Buffer containing all values in this set.
toBuffer() - Method in class jme3utilities.math.VectorSetUsingBuffer
Access a Buffer containing all values in this set.
toDegrees(float) - Static method in class jme3utilities.math.MyMath
Convert an angle from radians to degrees.
toFloatArray() - Method in interface jme3utilities.math.VectorSet
Create an array of floats containing all values in this set.
toFloatArray() - Method in class jme3utilities.math.VectorSetUsingBuffer
Create an array of floats containing all values in this set.
toHullShape() - Method in class com.jme3.bullet.collision.shapes.BoxCollisionShape
Approximate this shape with a HullCollisionShape.
toHullShape() - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Approximate this shape with a HullCollisionShape.
toHullShape() - Method in class com.jme3.bullet.collision.shapes.ConvexShape
Approximate this shape with a HullCollisionShape.
toHullShape() - Method in class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Approximate this shape with a HullCollisionShape.
toHullShape() - Method in class com.jme3.bullet.collision.shapes.MultiSphere
Approximate this shape with a HullCollisionShape.
toHullShape() - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Approximate this shape with a HullCollisionShape.
toHullShape() - Method in class com.jme3.bullet.collision.shapes.SphereCollisionShape
Approximate this shape with a HullCollisionShape.
toMap() - Method in class vhacd.VHACDParameters
Represent this instance as a Map, in order to make comparisons easier.
toMap() - Method in class vhacd4.Vhacd4Parameters
Represent this instance as a Map, in order to make comparisons easier.
toOutputStream(OutputStream) - Method in class vhacd.VHACDParameters
Write selected parameters to the specified OutputStream.
toOutputStream(OutputStream) - Method in class vhacd4.Vhacd4Parameters
Write all parameters to the specified OutputStream.
toQuaternion() - Method in class com.simsilica.mathd.Quatd
Creates a (single-precision) Quaternion that approximates the current instance.
toRadians(float) - Static method in class jme3utilities.math.MyMath
Convert an angle from degrees to radians.
toRotationMatrix() - Method in class com.jme3.math.Quaternion
Converts to an equivalent rotation matrix.
toRotationMatrix() - Method in class com.simsilica.mathd.Quatd
Converts the quaternion to an equivalent rotation matrix.
toRotationMatrix(Matrix3f) - Method in class com.jme3.math.Matrix4f
Determines the rotation component of the coordinate transform.
toRotationMatrix(Matrix3f) - Method in class com.jme3.math.Quaternion
Converts to an equivalent rotation matrix.
toRotationMatrix(Matrix4f) - Method in class com.jme3.math.Quaternion
Sets the rotation component of the specified transform matrix.
toRotationQuat(Quaternion) - Method in class com.jme3.math.Matrix4f
Returns the rotation component of the coordinate transform.
toScaleVector(Vector3f) - Method in class com.jme3.math.Matrix4f
Determines the scale component of the coordinate transform.
toSplittableShape() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Approximate this shape with a splittable shape.
toSplittableShape() - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Approximate this shape with a splittable shape.
toSplittableShape() - Method in class com.jme3.bullet.collision.shapes.ConvexShape
Approximate this shape with a splittable shape.
toSplittableShape() - Method in class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
Approximate this shape with a splittable shape.
toString() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Represent the collision object as a String.
toString() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Represent this CollisionShape as a String.
toString() - Method in class com.jme3.bullet.joints.PhysicsJoint
Represent this joint as a String.
toString() - Method in class com.jme3.bullet.NativePhysicsObject
Represent this instance as a String.
toString() - Method in class com.jme3.math.Matrix3f
Returns a string representation of the matrix, which is unaffected.
toString() - Method in class com.jme3.math.Matrix4f
Returns a string representation of the matrix, which is unaffected.
toString() - Method in class com.jme3.math.Plane
toString returns a string representation of this plane.
toString() - Method in class com.jme3.math.Quaternion
Returns a string representation of the quaternion, which is unaffected.
toString() - Method in class com.jme3.math.Transform
Returns a string representation of the transform, which is unaffected.
toString() - Method in class com.jme3.math.TransformDp
Returns a string representation of the transform, which is unaffected.
toString() - Method in class com.jme3.math.Vector3f
Returns a string representation of the vector, which is unaffected.
toString() - Method in class com.simsilica.mathd.Matrix3d
Returns a string representation of the matrix, which is unaffected.
toString() - Method in class com.simsilica.mathd.Quatd
Returns a string representation of the quaternion, which is unaffected.
toString() - Method in class com.simsilica.mathd.Vec3d
Returns a string representation of the vector, which is unaffected.
toString() - Method in class jme3utilities.math.IntPair
Represent this pair as a text string.
toString() - Method in class jme3utilities.math.RectangularSolid
Represent this solid as a text string.
toString() - Method in class jme3utilities.math.VectorSetUsingBuffer
Represent this set as a String.
toString() - Method in class vhacd.VHACDParameters
Represent this instance as a String.
toString() - Method in class vhacd4.Vhacd4Parameters
Represent this instance as a String.
totalAppliedForce(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Determine the total force applied to the body (excluding contact forces, damping, and gravity).
totalAppliedTorque(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsRigidBody
Determine the total torque applied to the body (excluding contact forces and damping).
toTransformMatrix() - Method in class com.jme3.math.Transform
Creates an equivalent transform matrix.
toTransformMatrix(Matrix4f) - Method in class com.jme3.math.Quaternion
Sets the rotation component of the specified transform matrix.
toTransformMatrix(Matrix4f) - Method in class com.jme3.math.Transform
Converts to an equivalent transform matrix.
toTranslationVector(Vector3f) - Method in class com.jme3.math.Matrix4f
Returns the translation component of the coordinate transform.
toVector3f() - Method in class com.simsilica.mathd.Vec3d
Creates a single-precision copy of the current instance.
toVectorArray() - Method in interface jme3utilities.math.VectorSet
Create an array of vectors containing all values in this set.
toVectorArray() - Method in class jme3utilities.math.VectorSetUsingBuffer
Create an array of vectors containing all values in this set.
transform(Transform, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyMath
Apply the specified transform to a Vector3f.
transform(FloatBuffer, int, int, Transform) - Static method in class jme3utilities.math.MyBuffer
Apply the specified coordinate transform to 3-D vectors in the specified FloatBuffer range.
Transform - Class in com.jme3.math
A 3-D coordinate transform composed of translation, rotation, and scaling.
Transform() - Constructor for class com.jme3.math.Transform
Instantiates an identity transform: no translation, no rotation, and no scaling.
Transform(Vector3f, Quaternion) - Constructor for class com.jme3.math.Transform
Instantiates a coordinate transform without scaling.
Transform(Vector3f, Quaternion, Vector3f) - Constructor for class com.jme3.math.Transform
Instantiates a coordinate transform with scaling.
TransformDp - Class in com.jme3.math
A 3-D coordinate transform composed of translation, rotation, and scaling.
TransformDp() - Constructor for class com.jme3.math.TransformDp
Instantiates an identity transform: no translation, no rotation, and no scaling.
TransformDp(TransformDp) - Constructor for class com.jme3.math.TransformDp
Instantiates a copy of the specified transform.
TransformDp(Vec3d, Quatd) - Constructor for class com.jme3.math.TransformDp
Instantiates a coordinate transform without scaling.
TransformDp(Vec3d, Quatd, Vec3d) - Constructor for class com.jme3.math.TransformDp
Instantiates a coordinate transform with scaling.
transformInverse(Transform, Triangle, Triangle) - Static method in class jme3utilities.math.MyMath
Apply the inverse of the specified transform to each vertex of a Triangle.
transformInverse(Transform, Vector3f, Vector3f) - Static method in class jme3utilities.math.MyMath
Apply the inverse of the specified transform to a Vector3f.
transformInverseVector(Vec3d, Vec3d) - Method in class com.jme3.math.TransformDp
Applies the inverse transform to the specified coordinates and returns the result in storeResult.
transformVector(Vec3d, Vec3d) - Method in class com.jme3.math.TransformDp
Transforms the specified coordinates and returns the result in storeResult.
translate(Vector3f) - Method in class com.jme3.bullet.collision.shapes.CompoundCollisionShape
Apply the specified translation (in the parent's coordinate system) to each child.
translate(FloatBuffer, int, int, Vector3f) - Static method in class jme3utilities.math.MyBuffer
Add the specified offset to 3-D vectors in the specified FloatBuffer range.
TranslationalLimitMotor - Class in com.jme3.bullet.joints.motors
A motor based on Bullet's btTranslationalLimitMotor, used to control the translation of a SixDofJoint.
TranslationalLimitMotor(long) - Constructor for class com.jme3.bullet.joints.motors.TranslationalLimitMotor
Instantiate a motor.
TranslationMotor - Class in com.jme3.bullet.joints.motors
A 3-axis motor based on Bullet's btTranslationalLimitMotor2, used to control the translation of a New6Dof constraint.
TranslationMotor(long) - Constructor for class com.jme3.bullet.joints.motors.TranslationMotor
Instantiate a motor.
transpose() - Method in class com.simsilica.mathd.Matrix3d
Returns the transpose.
traversalMode() - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Return the traversal mode (native field: m_traversalMode).
Triangle - Class in com.jme3.math
Describes a triangle in terms of its vertex locations, with auxiliary storage for its normal vector.
Triangle() - Constructor for class com.jme3.math.Triangle
Instantiate a zero-size triangle at the origin.
Triangle(Vector3f, Vector3f, Vector3f) - Constructor for class com.jme3.math.Triangle
Instantiates a triangle with the specified vertex locations.
triangleIndex() - Method in class com.jme3.bullet.collision.PhysicsRayTestResult
Read the triangle index at the point of contact.
triangleIndex() - Method in class com.jme3.bullet.collision.PhysicsSweepTestResult
Return the triangle index at the point of contact.
triangleIndex(int) - Method in class com.jme3.bullet.collision.shapes.infos.BoundingValueHierarchy
Return the triangle index of the specified node.
TWO_PI - Static variable in class com.jme3.math.FastMath
The value 2PI as a float.

U

unassignNativeObject() - Method in class com.jme3.bullet.NativePhysicsObject
Unassign (but don't free) the assigned native object, assuming that one is assigned.
UNIT_X - Static variable in class com.jme3.math.Vector3f
Shared instance of the +X direction (1,0,0).
UNIT_X - Static variable in class com.simsilica.mathd.Vec3d
Shared instance of the +X direction (1,0,0).
UNIT_XYZ - Static variable in class com.jme3.math.Vector3f
Shared instance of the all-ones vector (1,1,1).
UNIT_Y - Static variable in class com.jme3.math.Vector3f
Shared instance of the +Y direction (0,1,0).
UNIT_Y - Static variable in class com.simsilica.mathd.Vec3d
Shared instance of the +Y direction (0,1,0).
UNIT_Z - Static variable in class com.jme3.math.Vector3f
Shared instance of the +Z direction (0,0,1).
UNIT_Z - Static variable in class com.simsilica.mathd.Vec3d
Shared instance of the +Z direction (0,0,1).
unscaledVolume() - Method in class com.jme3.bullet.collision.shapes.BoxCollisionShape
Return the unscaled volume of the box.
unscaledVolume() - Method in class com.jme3.bullet.collision.shapes.CapsuleCollisionShape
Return the unscaled volume of the capsule.
unscaledVolume() - Method in class com.jme3.bullet.collision.shapes.ConeCollisionShape
Return the unscaled volume of the cone.
unscaledVolume() - Method in class com.jme3.bullet.collision.shapes.CylinderCollisionShape
Return the unscaled volume of the cylinder.
unscaledVolume() - Method in class com.jme3.bullet.collision.shapes.EmptyShape
Return the volume of the shape.
unscaledVolume() - Method in class com.jme3.bullet.collision.shapes.SimplexCollisionShape
Calculate the unscaled volume of the simplex.
unscaledVolume() - Method in class com.jme3.bullet.collision.shapes.SphereCollisionShape
Return the unscaled volume of the sphere.
upAxis() - Method in class com.jme3.bullet.collision.shapes.HeightfieldCollisionShape
Return the index of the height axis.
upAxisIndex() - Method in class com.jme3.bullet.objects.infos.VehicleController
Determine the index of the vehicle's up axis.
upAxisIndex() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Determine the index of this vehicle's up axis.
update(double, double, double, String, String) - Method in interface vhacd.VHACDProgressListener
Callback invoked (by native code) for progress updates.
update(float) - Method in class com.jme3.bullet.PhysicsSpace
Update the space.
update(float, int) - Method in class com.jme3.bullet.PhysicsSpace
Update the space.
update(float, int, boolean, boolean, boolean) - Method in class com.jme3.bullet.PhysicsSpace
Update the space.
updateClusterMesh(PhysicsSoftBody, Mesh, boolean) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Update the position buffer of a Mesh from the clusters in the specified soft body.
updateMesh(PhysicsSoftBody, IntBuffer, Mesh, boolean, boolean, Transform) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Update the position/normal buffers of a Mesh from the nodes in the specified soft body.
updatePhysicsState() - Method in class com.jme3.bullet.objects.VehicleWheel
Update this wheel's location and orientation.
updatePinMesh(PhysicsSoftBody, Mesh, boolean) - Static method in class com.jme3.bullet.util.NativeSoftBodyUtil
Update the position buffer of a Mesh from the pinned nodes in the specified soft body.
updateScale() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Synchronize the copied scale factors with the btCollisionShape.
updateSolver() - Method in class com.jme3.bullet.MultiBodySpace
Replace the existing contact-and-constraint solver with a new one of the correct type.
updateSolver() - Method in class com.jme3.bullet.PhysicsSpace
Replace the existing contact-and-constraint solver with a new one of the correct type.
updateWheels() - Method in class com.jme3.bullet.objects.PhysicsVehicle
Used internally.
updateWheelTransform(VehicleWheel) - Method in class com.jme3.bullet.objects.infos.VehicleController
Used internally.
UpperLimit - Enum constant in enum class com.jme3.bullet.joints.motors.MotorParam
constraint upper limit (m_hiLimit/m_upperLimit, default=-1[rot] or 0[translate])
Use2Directions - Static variable in class com.jme3.bullet.SolverMode
use 2 friction directions
useDeterministicDispatch(boolean) - Method in class com.jme3.bullet.CollisionSpace
Enable or disable the "deterministic overlapping pairs" option in the collision dispatcher (native field: m_deterministicOverlappingPairs).
useGlobalVelocities(boolean) - Method in class com.jme3.bullet.MultiBody
Alter whether this MultiBody uses global velocities.
user - Static variable in class com.jme3.bullet.collision.PcoType
unused (native name: CO_USER_TYPE)
userIndex() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision object's primary user index (native field: m_userIndex).
userIndex() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Return the primary user index (native field: m_userIndex).
userIndex() - Method in class com.jme3.bullet.MultiBody
Return the primary user index (native field: m_userIndex).
userIndex2() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision object's secondary user index (native field: m_userIndex2).
userIndex2() - Method in class com.jme3.bullet.collision.shapes.CollisionShape
Return the secondary user index (native field: m_userIndex2).
userIndex2() - Method in class com.jme3.bullet.MultiBody
Return the secondary user index (native field: m_userIndex2).
userIndex3() - Method in class com.jme3.bullet.collision.PhysicsCollisionObject
Return the collision object's tertiary user index (native field: m_userIndex3).
useRK4(boolean) - Method in class com.jme3.bullet.MultiBody
Alter whether this MultiBody uses RK4 integration.
useScr(boolean) - Method in class com.jme3.bullet.PhysicsSpace
Alter whether the space uses Speculative Contact Restitution (native field: m_applySpeculativeContactRestitution).

V

V_OneSided - Enum constant in enum class com.jme3.bullet.objects.infos.Aero
Vertex normals are taken as they are.
V_Point - Enum constant in enum class com.jme3.bullet.objects.infos.Aero
Vertex normals are oriented toward velocity.
V_TwoSided - Enum constant in enum class com.jme3.bullet.objects.infos.Aero
Vertex normals are flipped to match velocity.
V_TwoSidedLiftDrag - Enum constant in enum class com.jme3.bullet.objects.infos.Aero
Vertex normals are flipped to match velocity.
Validate - Class in jme3utilities
Utility methods to throw exceptions for invalid method arguments.
validateUnit(Quaternion, String, float) - Static method in class jme3utilities.math.MyQuaternion
Validate a normalized quaternion as a method argument.
valueOf(String) - Static method in enum class com.jme3.bullet.FillMode
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.joints.JointEnd
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.joints.motors.MotorParam
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.MultiBodyJointType
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.objects.infos.Aero
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.objects.infos.Cluster
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.objects.infos.Sbcp
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.PhysicsSpace.BroadphaseType
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.RotationOrder
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.bullet.SolverType
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.system.Platform.Os
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class com.jme3.system.Platform
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class jme3utilities.minie.DumpFlags
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class vhacd.ACDMode
Returns the enum constant of this class with the specified name.
values() - Static method in enum class com.jme3.bullet.FillMode
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.joints.JointEnd
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.joints.motors.MotorParam
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.MultiBodyJointType
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.objects.infos.Aero
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.objects.infos.Cluster
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.objects.infos.Sbcp
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.PhysicsSpace.BroadphaseType
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.RotationOrder
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.bullet.SolverType
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.system.Platform.Os
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class com.jme3.system.Platform
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class jme3utilities.minie.DumpFlags
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class vhacd.ACDMode
Returns an array containing the constants of this enum class, in the order they are declared.
Vec3d - Class in com.simsilica.mathd
A vector composed of 3 double-precision components, used to represent locations, offsets, velocities, and directions in 3-dimensional space.
Vec3d() - Constructor for class com.simsilica.mathd.Vec3d
Instantiates an all-zero vector (0,0,0).
Vec3d(double, double, double) - Constructor for class com.simsilica.mathd.Vec3d
Instantiates a vector with the specified components.
Vec3d(Vector3f) - Constructor for class com.simsilica.mathd.Vec3d
Instantiates a double-precision copy of the argument.
Vec3d(Vec3d) - Constructor for class com.simsilica.mathd.Vec3d
Instantiates a copy of the argument.
vect1 - Variable in class com.jme3.util.TempVars
General vectors.
vect2 - Variable in class com.jme3.util.TempVars
auxiliary Vector3f
Vector3f - Class in com.jme3.math
A vector composed of 3 single-precision components, used to represent locations, offsets, velocities, and directions in 3-dimensional space.
Vector3f() - Constructor for class com.jme3.math.Vector3f
Instantiates an all-zero vector (0,0,0).
Vector3f(float, float, float) - Constructor for class com.jme3.math.Vector3f
Instantiates a vector with specified components.
Vector3f(Vector3f) - Constructor for class com.jme3.math.Vector3f
Instantiates a copy of the argument.
VectorSet - Interface in jme3utilities.math
A collection of Vector3f values without duplicates.
VectorSetUsingBuffer - Class in jme3utilities.math
A VectorSet implemented using FloatBuffer.
VectorSetUsingBuffer(int, boolean) - Constructor for class jme3utilities.math.VectorSetUsingBuffer
Instantiate an empty set with the specified initial capacity.
VehicleController - Class in com.jme3.bullet.objects.infos
The "action" (controller) portion of a PhysicsVehicle, based on Bullet's btRaycastVehicle.
VehicleController(PhysicsVehicle, PhysicsSpace) - Constructor for class com.jme3.bullet.objects.infos.VehicleController
Instantiate a controller for the specified collision object.
VehicleTuning - Class in com.jme3.bullet.objects.infos
Tuning parameters for a PhysicsVehicle, based on Bullet's btVehicleTuning.
VehicleTuning() - Constructor for class com.jme3.bullet.objects.infos.VehicleTuning
Instantiate an instance with the default parameter values.
VehicleWheel - Class in com.jme3.bullet.objects
Information about one wheel of a vehicle, based on Bullet's btWheelInfo.
VehicleWheel(Vector3f, Vector3f, Vector3f, float, float, boolean) - Constructor for class com.jme3.bullet.objects.VehicleWheel
Instantiate a wheel.
VelocityCorrection - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
velocity correction factor (Baumgarte) (default=1, native field: kVCF)
velocityIterations() - Method in class com.jme3.bullet.objects.infos.SoftBodyConfig
Return the number of velocity-solver iterations (native field: viterations).
verifyMutable() - Method in class jme3utilities.lbj.IndexBuffer
Verify that the buffer is still mutable.
versionNumber() - Static method in class com.jme3.bullet.util.NativeLibrary
Determine the native library's version string.
VF_DD - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the Vertex-versus-Face handler for soft-versus-soft collisions
VF_SS - Static variable in class com.jme3.bullet.objects.infos.ConfigFlag
enable the Node-versus-Face handler for soft-versus-soft collisions
vhacd - package vhacd
Java API for Khaled Mamou’s Volumetric-Hierarchical Approximate Convex Decomposition (V-HACD) algorithm.
VHACD - Class in vhacd
Utility class to perform Volumetric-Hierarchical Approximate Convex Decomposition on an indexed mesh.
vhacd4 - package vhacd4
Java API for version 4 of Khaled Mamou’s Volumetric-Hierarchical Approximate Convex Decomposition (V-HACD) algorithm.
Vhacd4 - Class in vhacd4
Utility class to perform Volumetric-Hierarchical Approximate Convex Decomposition on an indexed mesh.
Vhacd4Hull - Class in vhacd4
A 3-D convex hull based on a V-HACD version 4 ConvexHull.
Vhacd4Parameters - Class in vhacd4
A set of tuning parameters for convex decomposition, based on version 4 of V-HACD's IVHACD::Parameters.
Vhacd4Parameters() - Constructor for class vhacd4.Vhacd4Parameters
Instantiate the default tuning parameters.
VHACDHull - Class in vhacd
A 3-D convex hull based on a V-HACD ConvexHull.
VHACDParameters - Class in vhacd
A set of tuning parameters for convex decomposition, based on classic V-HACD's IVHACD::Parameters.
VHACDParameters() - Constructor for class vhacd.VHACDParameters
Instantiate the default tuning parameters.
VHACDProgressListener - Interface in vhacd
Callback interface from V-HACD, used to report progress.
volume() - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Calculate the volume of this body.
VolumeConservation - Enum constant in enum class com.jme3.bullet.objects.infos.Sbcp
volume conservation coefficient (≥0, default=0, native field: kVC)
volumeConvex() - Method in class com.jme3.bullet.collision.shapes.infos.IndexedMesh
Calculate volume of the mesh, assuming it's both closed and convex.
volumeConvex(ConvexShape, int) - Static method in class com.jme3.bullet.util.DebugShapeFactory
Calculate the volume of a debug mesh for the specified convex shape.
volumeStiffness() - Method in class com.jme3.bullet.objects.infos.SoftBodyMaterial
Read the volume-stiffness coefficient (native field: m_kVST).
VOXEL - Enum constant in enum class vhacd.ACDMode
m_mode = 0: use voxels

W

w - Variable in class com.jme3.math.Quaternion
The real (W) component.
w - Variable in class com.simsilica.mathd.Quatd
The real (W) component.
wantsDeactivation - Static variable in class com.jme3.bullet.collision.Activation
a collision object that's timed out but hasn't been deactivated yet? (native name: WANTS_DEACTIVATION)
WarmStart - Static variable in class com.jme3.bullet.SolverMode
use warm start
warp(Vector3f) - Method in class com.jme3.bullet.objects.infos.CharacterController
Directly alter the location of the character's center.
warp(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsCharacter
Directly alter the location of this character's center.
warpDp(Vec3d) - Method in class com.jme3.bullet.objects.infos.CharacterController
Directly alter the location of the character's center.
waterDensity() - Method in class com.jme3.bullet.SoftBodyWorldInfo
Return the water density.
waterOffset() - Method in class com.jme3.bullet.SoftBodyWorldInfo
Return the water offset.
Windows - Enum constant in enum class com.jme3.system.Platform.Os
Microsoft Windows operating systems
Windows_ARM32 - Enum constant in enum class com.jme3.system.Platform
Microsoft Windows 32-bit ARM
Windows_ARM64 - Enum constant in enum class com.jme3.system.Platform
Microsoft Windows 64-bit ARM
Windows32 - Enum constant in enum class com.jme3.system.Platform
Microsoft Windows 32-bit AMD/Intel
Windows64 - Enum constant in enum class com.jme3.system.Platform
Microsoft Windows 64-bit AMD/Intel
windVelocity(Vector3f) - Method in class com.jme3.bullet.objects.PhysicsSoftBody
Copy the wind velocity.
worldTransform(Transform) - Method in class com.jme3.bullet.MultiBodyLink
Determine the transform of this link.
wrapIndexBuffer(Buffer) - Static method in class jme3utilities.lbj.IndexBuffer
Create a mutable IndexBuffer by wrapping the specified data buffer.

X

x - Variable in class com.jme3.math.Quaternion
The first imaginary (X) component.
x - Variable in class com.jme3.math.Vector3f
The first (X) component.
x - Variable in class com.simsilica.mathd.Quatd
The first imaginary (X) component.
x - Variable in class com.simsilica.mathd.Vec3d
The first (X) component.
xAxis - Static variable in class jme3utilities.math.MyVector3f
index of the X axis
XYZ - Enum constant in enum class com.jme3.bullet.RotationOrder
X then Y then Z (native name: RO_XYZ)
XZY - Enum constant in enum class com.jme3.bullet.RotationOrder
X then Z then Y (native name: RO_XZY)

Y

y - Variable in class com.jme3.math.Quaternion
The 2nd imaginary (Y) component.
y - Variable in class com.jme3.math.Vector3f
The 2nd (Y) component.
y - Variable in class com.simsilica.mathd.Quatd
The 2nd imaginary (Y) component.
y - Variable in class com.simsilica.mathd.Vec3d
The 2nd (Y) component.
yAxis - Static variable in class jme3utilities.math.MyVector3f
index of the Y axis
yMax() - Method in class com.jme3.bullet.collision.shapes.SphericalSegment
Return the Y offset of the upper base from the center of the parent sphere.
yMin() - Method in class com.jme3.bullet.collision.shapes.SphericalSegment
Return the Y offset of the lower base from the center of the parent sphere.
YXZ - Enum constant in enum class com.jme3.bullet.RotationOrder
Y then X then Z (native name: RO_YXZ)
YZX - Enum constant in enum class com.jme3.bullet.RotationOrder
Y then Z then X (native name: RO_YZX)

Z

z - Variable in class com.jme3.math.Quaternion
The 3rd imaginary (Z) component.
z - Variable in class com.jme3.math.Vector3f
The 3rd (Z) component.
z - Variable in class com.simsilica.mathd.Quatd
The 3rd imaginary (Z) component.
z - Variable in class com.simsilica.mathd.Vec3d
The 3rd (Z) component.
zAxis - Static variable in class jme3utilities.math.MyVector3f
index of the Z axis
zero() - Method in class com.jme3.math.Matrix3f
Sets all elements to zero.
zero() - Method in class com.jme3.math.Matrix4f
Sets all elements to zero.
zero() - Method in class com.jme3.math.Vector3f
Sets all 3 components to zero.
ZERO - Static variable in class com.jme3.math.Matrix3f
Shared instance of the all-zero matrix.
ZERO - Static variable in class com.jme3.math.Quaternion
Shared instance of the zero quaternion (0, 0, 0, 0).
ZERO - Static variable in class com.jme3.math.Vector3f
Shared instance of the all-zero vector (0,0,0).
ZERO - Static variable in class com.simsilica.mathd.Vec3d
Shared instance of the all-zero vector (0,0,0).
ZXY - Enum constant in enum class com.jme3.bullet.RotationOrder
Z then X then Y (native name: RO_ZXY)
ZYX - Enum constant in enum class com.jme3.bullet.RotationOrder
Z then Y then X (native name: RO_ZYX)
A B C D E F G H I J K L M N O P Q R S T U V W X Y Z 
All Classes and Interfaces|All Packages|Constant Field Values|Serialized Form