Versions in this module Expand all Collapse all v1 v1.0.1 Jan 14, 2025 Changes in this version + const AMotorEuler + const AMotorJointType + const AMotorUser + const AllAFlag + const Approx0CtParam + const Approx11CtParam + const Approx12CtParam + const Approx1CtParam + const Approx1NCtParam + const AxisDepCtParam + const BallJointType + const BasicDataAFlag + const BounceCtParam + const BounceJtParam + const BounceJtParam1 + const BounceJtParam2 + const BounceJtParam3 + const BoxClass + const CFMJtParam + const CFMJtParam1 + const CFMJtParam2 + const CFMJtParam3 + const CapsuleClass + const CollisionDataAFlag + const ContactJointType + const ConvexClass + const CylinderClass + const DBallJointType + const DHingeJointType + const ERPJtParam + const ERPJtParam1 + const ERPJtParam2 + const ERPJtParam3 + const FDir1CtParam + const FMaxJtParam + const FMaxJtParam1 + const FMaxJtParam2 + const FMaxJtParam3 + const FirstSpaceClass + const FirstUserClass + const FixedJointType + const FudgeFactorJtParam + const FudgeFactorJtParam1 + const FudgeFactorJtParam2 + const FudgeFactorJtParam3 + const HashSpaceClass + const HeightfieldClass + const HiStopJtParam + const HiStopJtParam1 + const HiStopJtParam2 + const HiStopJtParam3 + const HiVelJtParam + const HiVelJtParam1 + const HiVelJtParam2 + const HiVelJtParam3 + const Hinge2JointType + const HingeJointType + const JtParamGroup1 + const JtParamGroup2 + const JtParamGroup3 + const LMotorJointType + const LastSpaceClass + const LastUserClass + const LoStopJtParam + const LoStopJtParam1 + const LoStopJtParam2 + const LoStopJtParam3 + const LoVelJtParam + const LoVelJtParam1 + const LoVelJtParam2 + const LoVelJtParam3 + const ManualThreadCleanupIFlag + const MaxUserClasses + const Motion1CtParam + const Motion2CtParam + const MotionNCtParam + const Mu2CtParam + const NullJointType + const NumClasses + const NumJtParams + const PRJointType + const PUJointType + const PistonJointType + const Plane2DJointType + const PlaneClass + const QuadTreeSpaceClass + const RayClass + const RollingCtParam + const SAPAxesXYZ + const SAPAxesXZY + const SAPAxesYXZ + const SAPAxesYZX + const SAPAxesZXY + const SAPAxesZYX + const SimpleSpaceClass + const SliderJointType + const Slip1CtParam + const Slip2CtParam + const SoftCFMCtParam + const SoftERPCtParam + const SphereClass + const StopCFMJtParam + const StopCFMJtParam1 + const StopCFMJtParam2 + const StopCFMJtParam3 + const StopERPJtParam + const StopERPJtParam1 + const StopERPJtParam2 + const StopERPJtParam3 + const SuspensionCFMJtParam + const SuspensionCFMJtParam1 + const SuspensionCFMJtParam2 + const SuspensionCFMJtParam3 + const SuspensionERPJtParam + const SuspensionERPJtParam1 + const SuspensionERPJtParam2 + const SuspensionERPJtParam3 + const SweepAndPruneSpaceClass + const TransmissionChainDrive + const TransmissionIntersectingAxes + const TransmissionJointType + const TransmissionParallelAxes + const TriMeshClass + const UniversalJointType + const VelJtParam + const VelJtParam1 + const VelJtParam2 + const VelJtParam3 + const WorldStepThreadCountUnlimited + var BB = NewAABB + var M3 = NewMatrix3 + var M4 = NewMatrix4 + var Q = NewQuaternion + var V3 = NewVector3 + var V4 = NewVector4 + func CleanupAllDataForThread() + func Close() + func Init(initFlags, allocFlags int) + type AABB Vector + func NewAABB(vals ...float64) AABB + type AMotorJoint struct + func (j AMotorJoint) AddTorques(torque1, torque2, torque3 float64) + func (j AMotorJoint) Angle(num int) float64 + func (j AMotorJoint) AngleRate(num int) float64 + func (j AMotorJoint) Axis(num int) Vector3 + func (j AMotorJoint) AxisRel(num int) int + func (j AMotorJoint) Mode() int + func (j AMotorJoint) NumAxes() int + func (j AMotorJoint) Param(parameter int) float64 + func (j AMotorJoint) SetAngle(num int, angle float64) + func (j AMotorJoint) SetAxis(num, rel int, axis Vector3) + func (j AMotorJoint) SetMode(mode int) + func (j AMotorJoint) SetNumAxes(num int) + func (j AMotorJoint) SetParam(parameter int, value float64) + type BallJoint struct + func (j BallJoint) Anchor() Vector3 + func (j BallJoint) Anchor2() Vector3 + func (j BallJoint) Param(parameter int) float64 + func (j BallJoint) SetAnchor(pt Vector3) + func (j BallJoint) SetAnchor2(pt Vector3) + func (j BallJoint) SetParam(parameter int, value float64) + type Body uintptr + func (b Body) AddForce(force Vector3) + func (b Body) AddForceAtPos(force, pos Vector3) + func (b Body) AddForceAtRelPos(force, pos Vector3) + func (b Body) AddRelForce(force Vector3) + func (b Body) AddRelForceAtPos(force, pos Vector3) + func (b Body) AddRelForceAtRelPos(force, pos Vector3) + func (b Body) AddRelTorque(torque Vector3) + func (b Body) AddTorque(torque Vector3) + func (b Body) AngularDamping() float64 + func (b Body) AngularDampingThreshold() float64 + func (b Body) AngularVel() Vector3 + func (b Body) AutoDisable() bool + func (b Body) AutoDisableAngularThreshold() float64 + func (b Body) AutoDisableAverageSamplesCount() int + func (b Body) AutoDisableLinearThreshold() float64 + func (b Body) AutoDisableSteps() int + func (b Body) AutoDisableTime() float64 + func (b Body) Connected(other Body) bool + func (b Body) ConnectedExcluding(other Body, jointType int) bool + func (b Body) ConnectingJoint(other Body) Joint + func (b Body) ConnectingJointList(other Body) []Joint + func (b Body) Data() interface{} + func (b Body) Destroy() + func (b Body) Enabled() bool + func (b Body) FiniteRotationAxis() Vector3 + func (b Body) FiniteRotationMode() bool + func (b Body) FirstGeom() Geom + func (b Body) Force() Vector3 + func (b Body) GravityEnabled() bool + func (b Body) GyroModeEnabled() bool + func (b Body) Joint(index int) Joint + func (b Body) Kinematic() bool + func (b Body) LinearDamping() float64 + func (b Body) LinearDampingThreshold() float64 + func (b Body) LinearVelocity() Vector3 + func (b Body) Mass() *Mass + func (b Body) MaxAngularSpeed() float64 + func (b Body) NumJoints() int + func (b Body) PointVel(pt Vector3) Vector3 + func (b Body) PosRelPoint(pos Vector3) Vector3 + func (b Body) Position() Vector3 + func (b Body) Quaternion() Quaternion + func (b Body) RelPointPos(pt Vector3) Vector3 + func (b Body) RelPointVel(pt Vector3) Vector3 + func (b Body) Rotation() Matrix3 + func (b Body) SetAngularDamping(scale float64) + func (b Body) SetAngularDampingThreshold(threshold float64) + func (b Body) SetAngularVelocity(vel Vector3) + func (b Body) SetAutoAutoDisableAverageSamplesCount(count int) + func (b Body) SetAutoDisable(doAutoDisable bool) + func (b Body) SetAutoDisableAngularThreshold(thresh float64) + func (b Body) SetAutoDisableDefaults() + func (b Body) SetAutoDisableLinearThreshold(thresh float64) + func (b Body) SetAutoDisableSteps(steps int) + func (b Body) SetAutoDisableTime(time float64) + func (b Body) SetDampingDefaults() + func (b Body) SetData(data interface{}) + func (b Body) SetEnabled(isEnabled bool) + func (b Body) SetFiniteRotationAxis(axis Vector3) + func (b Body) SetFiniteRotationMode(isFinite bool) + func (b Body) SetForce(force Vector3) + func (b Body) SetGravityEnabled(isGravityEnabled bool) + func (b Body) SetGyroModeEnabled(isEnabled bool) + func (b Body) SetKinematic(isKinematic bool) + func (b Body) SetLinearDamping(scale float64) + func (b Body) SetLinearDampingThreshold(threshold float64) + func (b Body) SetLinearVelocity(vel Vector3) + func (b Body) SetMass(mass *Mass) + func (b Body) SetMaxAngularSpeed(maxSpeed float64) + func (b Body) SetMovedCallback(cb MovedCallback) + func (b Body) SetPosition(pos Vector3) + func (b Body) SetQuaternion(quat Quaternion) + func (b Body) SetRotation(rot Matrix3) + func (b Body) SetTorque(torque Vector3) + func (b Body) Torque() Vector3 + func (b Body) VectorFromWorld(wld Vector3) Vector3 + func (b Body) VectorToWorld(vec Vector3) Vector3 + func (b Body) World() World + type Box struct + func (b Box) Lengths() Vector3 + func (b Box) PointDepth(pt Vector3) float64 + func (b Box) SetLengths(lens Vector3) + type Capsule struct + func (c Capsule) Params() (float64, float64) + func (c Capsule) PointDepth(pt Vector3) float64 + func (c Capsule) SetParams(radius, length float64) + type Contact struct + FDir1 Vector3 + Geom ContactGeom + Surface SurfaceParameters + func NewContact() *Contact + type ContactGeom struct + Depth float64 + G1 Geom + G2 Geom + Normal Vector3 + Pos Vector3 + Side1 int + Side2 int + func NewContactGeom() *ContactGeom + type ContactJoint struct + type Convex struct + func (c Convex) Set(planes PlaneList, pts VertexList, polyList PolygonList) + type Cylinder struct + func (c Cylinder) Params() (float64, float64) + func (c Cylinder) SetParams(radius, length float64) + type DBallJoint struct + func (j DBallJoint) Anchor1() Vector3 + func (j DBallJoint) Anchor2() Vector3 + func (j DBallJoint) Distance() float64 + func (j DBallJoint) Param(parameter int) float64 + func (j DBallJoint) SetAnchor1(pt Vector3) + func (j DBallJoint) SetAnchor2(pt Vector3) + func (j DBallJoint) SetParam(parameter int, value float64) + type DHingeJoint struct + func (j DHingeJoint) Anchor1() Vector3 + func (j DHingeJoint) Anchor2() Vector3 + func (j DHingeJoint) Axis() Vector3 + func (j DHingeJoint) Distance() float64 + func (j DHingeJoint) Param(parameter int) float64 + func (j DHingeJoint) SetAnchor1(pt Vector3) + func (j DHingeJoint) SetAnchor2(pt Vector3) + func (j DHingeJoint) SetAxis(axis Vector3) + func (j DHingeJoint) SetParam(parameter int, value float64) + type FixedJoint struct + func (j FixedJoint) Fix() + func (j FixedJoint) Param(parameter int) float64 + func (j FixedJoint) SetParam(parameter int, value float64) + type Geom interface + AABB func() AABB + Body func() Body + CategoryBits func() int + Class func() int + ClearOffset func() + Collide func(other Geom, maxContacts uint16, flags int) []ContactGeom + Collide2 func(other Geom, data interface{}, cb NearCallback) + CollideBits func() int + Data func() interface{} + Destroy func() + Enabled func() bool + IsOffset func() bool + IsSpace func() bool + Next func() Geom + OffsetPosition func() Vector3 + OffsetQuaternion func() Quaternion + OffsetRotation func() Matrix3 + PosRelPoint func(pos Vector3) Vector3 + Position func() Vector3 + Quaternion func() Quaternion + RelPointPos func(pt Vector3) Vector3 + Rotation func() Matrix3 + SetBody func(body Body) + SetCategoryBits func(bits int) + SetCollideBits func(bits int) + SetData func(data interface{}) + SetEnabled func(isEnabled bool) + SetOffsetPosition func(pos Vector3) + SetOffsetQuaternion func(quat Quaternion) + SetOffsetRotation func(rot Matrix3) + SetOffsetWorldPosition func(pos Vector3) + SetOffsetWorldQuaternion func(quat Quaternion) + SetOffsetWorldRotation func(rot Matrix3) + SetPosition func(pos Vector3) + SetQuaternion func(quat Quaternion) + SetRotation func(rot Matrix3) + Space func() Space + VectorFromWorld func(wld Vector3) Vector3 + VectorToWorld func(vec Vector3) Vector3 + type GeomBase uintptr + func (g GeomBase) AABB() AABB + func (g GeomBase) Body() Body + func (g GeomBase) CategoryBits() int + func (g GeomBase) Class() int + func (g GeomBase) ClearOffset() + func (g GeomBase) Collide(other Geom, maxContacts uint16, flags int) []ContactGeom + func (g GeomBase) Collide2(other Geom, data interface{}, cb NearCallback) + func (g GeomBase) CollideBits() int + func (g GeomBase) Data() interface{} + func (g GeomBase) Destroy() + func (g GeomBase) Enabled() bool + func (g GeomBase) IsOffset() bool + func (g GeomBase) IsSpace() bool + func (g GeomBase) Next() Geom + func (g GeomBase) OffsetPosition() Vector3 + func (g GeomBase) OffsetQuaternion() Quaternion + func (g GeomBase) OffsetRotation() Matrix3 + func (g GeomBase) PosRelPoint(pos Vector3) Vector3 + func (g GeomBase) Position() Vector3 + func (g GeomBase) Quaternion() Quaternion + func (g GeomBase) RelPointPos(pt Vector3) Vector3 + func (g GeomBase) Rotation() Matrix3 + func (g GeomBase) SetBody(body Body) + func (g GeomBase) SetCategoryBits(bits int) + func (g GeomBase) SetCollideBits(bits int) + func (g GeomBase) SetData(data interface{}) + func (g GeomBase) SetEnabled(isEnabled bool) + func (g GeomBase) SetOffsetPosition(pos Vector3) + func (g GeomBase) SetOffsetQuaternion(quat Quaternion) + func (g GeomBase) SetOffsetRotation(rot Matrix3) + func (g GeomBase) SetOffsetWorldPosition(pos Vector3) + func (g GeomBase) SetOffsetWorldQuaternion(quat Quaternion) + func (g GeomBase) SetOffsetWorldRotation(rot Matrix3) + func (g GeomBase) SetPosition(pos Vector3) + func (g GeomBase) SetQuaternion(quat Quaternion) + func (g GeomBase) SetRotation(rot Matrix3) + func (g GeomBase) Space() Space + func (g GeomBase) VectorFromWorld(wld Vector3) Vector3 + func (g GeomBase) VectorToWorld(vec Vector3) Vector3 + type HashSpace struct + func (s HashSpace) Levels() (int, int) + func (s HashSpace) SetLevels(min, max int) + type Heightfield struct + func (h Heightfield) Build(data HeightfieldData, heightSamples Matrix, ...) + func (h Heightfield) HeightfieldData() HeightfieldData + func (h Heightfield) SetBounds(data HeightfieldData, minHeight, maxHeight float64) + func (h Heightfield) SetHeightfieldData(data HeightfieldData) + type HeightfieldData uintptr + func NewHeightfieldData() HeightfieldData + func (h *HeightfieldData) Destroy() + type Hinge2Joint struct + func (j Hinge2Joint) AddTorques(torque1, torque2 float64) + func (j Hinge2Joint) Anchor() Vector3 + func (j Hinge2Joint) Anchor2() Vector3 + func (j Hinge2Joint) Angle1() float64 + func (j Hinge2Joint) Angle1Rate() float64 + func (j Hinge2Joint) Angle2() float64 + func (j Hinge2Joint) Angle2Rate() float64 + func (j Hinge2Joint) Axis1() Vector3 + func (j Hinge2Joint) Axis2() Vector3 + func (j Hinge2Joint) Param(parameter int) float64 + func (j Hinge2Joint) SetAnchor(pt Vector3) + func (j Hinge2Joint) SetAxis1(axis Vector3) + func (j Hinge2Joint) SetAxis2(axis Vector3) + func (j Hinge2Joint) SetParam(parameter int, value float64) + type HingeJoint struct + func (j HingeJoint) AddTorque(torque float64) + func (j HingeJoint) Anchor() Vector3 + func (j HingeJoint) Anchor2() Vector3 + func (j HingeJoint) Angle() float64 + func (j HingeJoint) AngleRate() float64 + func (j HingeJoint) Axis() Vector3 + func (j HingeJoint) Param(parameter int) float64 + func (j HingeJoint) SetAnchor(pt Vector3) + func (j HingeJoint) SetAnchorDelta(pt, delta Vector3) + func (j HingeJoint) SetAxis(axis Vector3) + func (j HingeJoint) SetAxisOffset(axis Vector3, angle float64) + func (j HingeJoint) SetParam(parameter int, value float64) + type Joint interface + Attach func(body1, body2 Body) + Body func(index int) Body + Data func() interface{} + Destroy func() + Enabled func() bool + Feedback func() *JointFeedback + NumBodies func() int + SetData func(data interface{}) + SetEnabled func(isEnabled bool) + SetFeedback func(f *JointFeedback) + Type func() int + type JointBase uintptr + func (j JointBase) Attach(body1, body2 Body) + func (j JointBase) Body(index int) Body + func (j JointBase) Data() interface{} + func (j JointBase) Destroy() + func (j JointBase) Enabled() bool + func (j JointBase) Feedback() *JointFeedback + func (j JointBase) NumBodies() int + func (j JointBase) SetData(data interface{}) + func (j JointBase) SetEnabled(isEnabled bool) + func (j JointBase) SetFeedback(f *JointFeedback) + func (j JointBase) Type() int + type JointFeedback struct + Force1 Vector3 + Force2 Vector3 + Torque1 Vector3 + Torque2 Vector3 + type JointGroup uintptr + func NewJointGroup(maxJoints int) JointGroup + func (g JointGroup) Destroy() + func (g JointGroup) Empty() + type LMotorJoint struct + func (j LMotorJoint) Axis(num int) Vector3 + func (j LMotorJoint) NumAxes() int + func (j LMotorJoint) Param(parameter int) float64 + func (j LMotorJoint) SetAxis(num, rel int, axis Vector3) + func (j LMotorJoint) SetNumAxes(num int) + func (j LMotorJoint) SetParam(parameter int, value float64) + type Mass struct + Center Vector3 + Inertia Matrix3 + Mass float64 + func NewMass() *Mass + func (m *Mass) Add(other *Mass) + func (m *Mass) Adjust(mass float64) + func (m *Mass) Check() bool + func (m *Mass) Rotate(rot Matrix3) + func (m *Mass) SetBox(density float64, lens Vector3) + func (m *Mass) SetBoxTotal(totalMass float64, lens Vector3) + func (m *Mass) SetCapsule(density float64, direction int, radius, length float64) + func (m *Mass) SetCapsuleTotal(totalMass float64, direction int, radius, length float64) + func (m *Mass) SetCylinder(density float64, direction int, radius, length float64) + func (m *Mass) SetCylinderTotal(totalMass float64, direction int, radius, length float64) + func (m *Mass) SetParams(mass float64, com Vector3, inert Matrix3) + func (m *Mass) SetSphere(density, radius float64) + func (m *Mass) SetSphereTotal(totalMass, radius float64) + func (m *Mass) SetTriMesh(density float64, mesh TriMesh) + func (m *Mass) SetTriMeshTotal(totalMass float64, mesh TriMesh) + func (m *Mass) SetZero() + func (m *Mass) Translate(vec Vector3) + type Matrix [][]float64 + func NewMatrix(numRows, numCols, align int, vals ...float64) Matrix + type Matrix3 Matrix + func NewMatrix3(vals ...float64) Matrix3 + type Matrix4 Matrix + func NewMatrix4(vals ...float64) Matrix4 + type MovedCallback func(b Body) + type NearCallback func(data interface{}, obj1, obj2 Geom) + type NullJoint struct + type PRJoint struct + func (j PRJoint) AddTorque(torque float64) + func (j PRJoint) Anchor() Vector3 + func (j PRJoint) Angle() float64 + func (j PRJoint) AngleRate() float64 + func (j PRJoint) Axis1() Vector3 + func (j PRJoint) Axis2() Vector3 + func (j PRJoint) Param(parameter int) float64 + func (j PRJoint) Position() float64 + func (j PRJoint) PositionRate() float64 + func (j PRJoint) SetAnchor(pt Vector3) + func (j PRJoint) SetAxis1(axis Vector3) + func (j PRJoint) SetAxis2(axis Vector3) + func (j PRJoint) SetParam(parameter int, value float64) + type PUJoint struct + func (j PUJoint) Anchor() Vector3 + func (j PUJoint) Angle1() float64 + func (j PUJoint) Angle1Rate() float64 + func (j PUJoint) Angle2() float64 + func (j PUJoint) Angle2Rate() float64 + func (j PUJoint) Angles() (float64, float64) + func (j PUJoint) Axis1() Vector3 + func (j PUJoint) Axis2() Vector3 + func (j PUJoint) Axis3() Vector3 + func (j PUJoint) Param(parameter int) float64 + func (j PUJoint) Position() float64 + func (j PUJoint) PositionRate() float64 + func (j PUJoint) SetAnchor(pt Vector3) + func (j PUJoint) SetAnchorOffset(pt, delta Vector3) + func (j PUJoint) SetAxis1(axis Vector3) + func (j PUJoint) SetAxis2(axis Vector3) + func (j PUJoint) SetAxis3(axis Vector3) + func (j PUJoint) SetParam(parameter int, value float64) + type PistonJoint struct + func (j PistonJoint) AddForce(force float64) + func (j PistonJoint) Anchor2() Vector3 + func (j PistonJoint) Angle() float64 + func (j PistonJoint) AngleRate() float64 + func (j PistonJoint) Axis() Vector3 + func (j PistonJoint) Param(parameter int) float64 + func (j PistonJoint) Position() float64 + func (j PistonJoint) PositionRate() float64 + func (j PistonJoint) SetAnchor(pt Vector3) + func (j PistonJoint) SetAnchorOffset(pt, delta Vector3) + func (j PistonJoint) SetAxis(axis Vector3) + func (j PistonJoint) SetParam(parameter int, value float64) + type Plane struct + func (p Plane) Params() Vector4 + func (p Plane) PointDepth(pt Vector3) float64 + func (p Plane) SetParams(params Vector4) + type Plane2DJoint struct + func (j Plane2DJoint) SetAngleParam(parameter int, value float64) + func (j Plane2DJoint) SetXParam(parameter int, value float64) + func (j Plane2DJoint) SetYParam(parameter int, value float64) + type PlaneList Matrix + func NewPlaneList(size int, vals ...float64) PlaneList + type PolygonList []C.uint + type QuadTreeSpace struct + type Quaternion Vector + func NewQuaternion(vals ...float64) Quaternion + type Ray struct + func (r Ray) BackfaceCull() bool + func (r Ray) ClosestHit() bool + func (r Ray) FirstContact() bool + func (r Ray) Length() float64 + func (r Ray) PosDir() (Vector3, Vector3) + func (r Ray) SetBackfaceCull(backfaceCull bool) + func (r Ray) SetClosestHit(closestHit bool) + func (r Ray) SetFirstContact(firstContact bool) + func (r Ray) SetLength(length float64) + func (r Ray) SetPosDir(pos, dir Vector3) + type SimpleSpace struct + type SliderJoint struct + func (j SliderJoint) AddForce(force float64) + func (j SliderJoint) Axis() Vector3 + func (j SliderJoint) Param(parameter int) float64 + func (j SliderJoint) Position() float64 + func (j SliderJoint) PositionRate() float64 + func (j SliderJoint) SetAxis(axis Vector3) + func (j SliderJoint) SetAxisDelta(pt, delta Vector3) + func (j SliderJoint) SetParam(parameter int, value float64) + type Space interface + Add func(g Geom) + Class func() int + Clean func() + Cleanup func() bool + Collide func(data interface{}, cb NearCallback) + Destroy func() + Geom func(index int) Geom + ManualCleanup func() bool + NewBox func(lens Vector3) Box + NewCapsule func(radius, length float64) Capsule + NewCylinder func(radius, length float64) Cylinder + NewHashSpace func() HashSpace + NewHeightfield func(data HeightfieldData, placeable bool) Heightfield + NewPlane func(params Vector4) Plane + NewQuadTreeSpace func(center, extents Vector3, depth int) QuadTreeSpace + NewRay func(length float64) Ray + NewSimpleSpace func() SimpleSpace + NewSphere func(radius float64) Sphere + NewSweepAndPruneSpace func(axisOrder int) SweepAndPruneSpace + NumGeoms func(g Geom) int + Query func(g Geom) bool + Remove func(g Geom) + SetCleanup func(mode bool) + SetManualCleanup func(mode bool) + SetSublevel func(sublevel int) + Sublevel func() int + func NilSpace() Space + type SpaceBase uintptr + func (s SpaceBase) Add(g Geom) + func (s SpaceBase) Class() int + func (s SpaceBase) Clean() + func (s SpaceBase) Cleanup() bool + func (s SpaceBase) Collide(data interface{}, cb NearCallback) + func (s SpaceBase) Destroy() + func (s SpaceBase) Geom(index int) Geom + func (s SpaceBase) ManualCleanup() bool + func (s SpaceBase) NewBox(lens Vector3) Box + func (s SpaceBase) NewCapsule(radius, length float64) Capsule + func (s SpaceBase) NewConvex(planes PlaneList, pts VertexList, polyList PolygonList) Convex + func (s SpaceBase) NewCylinder(radius, length float64) Cylinder + func (s SpaceBase) NewHashSpace() HashSpace + func (s SpaceBase) NewHeightfield(data HeightfieldData, placeable bool) Heightfield + func (s SpaceBase) NewPlane(params Vector4) Plane + func (s SpaceBase) NewQuadTreeSpace(center, extents Vector3, depth int) QuadTreeSpace + func (s SpaceBase) NewRay(length float64) Ray + func (s SpaceBase) NewSimpleSpace() SimpleSpace + func (s SpaceBase) NewSphere(radius float64) Sphere + func (s SpaceBase) NewSweepAndPruneSpace(axisOrder int) SweepAndPruneSpace + func (s SpaceBase) NewTriMesh(data TriMeshData) TriMesh + func (s SpaceBase) NumGeoms(g Geom) int + func (s SpaceBase) Query(g Geom) bool + func (s SpaceBase) Remove(g Geom) + func (s SpaceBase) SetCleanup(mode bool) + func (s SpaceBase) SetManualCleanup(mode bool) + func (s SpaceBase) SetSublevel(sublevel int) + func (s SpaceBase) Sublevel() int + type Sphere struct + func (s Sphere) Radius() float64 + func (s Sphere) SetRadius(radius float64) + func (s Sphere) SpherePointDepth(pt Vector3) float64 + type SurfaceParameters struct + Bounce float64 + BounceVel float64 + Mode int + Motion1 float64 + Motion2 float64 + MotionN float64 + Mu float64 + Mu2 float64 + Rho float64 + Rho2 float64 + RhoN float64 + Slip1 float64 + Slip2 float64 + SoftCfm float64 + SoftErp float64 + type SweepAndPruneSpace struct + type TransmissionJoint struct + func (j TransmissionJoint) Anchor1() Vector3 + func (j TransmissionJoint) Anchor2() Vector3 + func (j TransmissionJoint) Angle1() float64 + func (j TransmissionJoint) Angle2() float64 + func (j TransmissionJoint) Axis() Vector3 + func (j TransmissionJoint) Axis1() Vector3 + func (j TransmissionJoint) Axis2() Vector3 + func (j TransmissionJoint) Backlash() float64 + func (j TransmissionJoint) ContactPoint1() Vector3 + func (j TransmissionJoint) ContactPoint2() Vector3 + func (j TransmissionJoint) Mode() int + func (j TransmissionJoint) Param(parameter int) float64 + func (j TransmissionJoint) Radius1() float64 + func (j TransmissionJoint) Radius2() float64 + func (j TransmissionJoint) Ratio() float64 + func (j TransmissionJoint) SetAnchor1(pt Vector3) + func (j TransmissionJoint) SetAnchor2(pt Vector3) + func (j TransmissionJoint) SetAxis(axis Vector3) + func (j TransmissionJoint) SetAxis1(axis Vector3) + func (j TransmissionJoint) SetAxis2(axis Vector3) + func (j TransmissionJoint) SetBacklash(backlash float64) + func (j TransmissionJoint) SetMode(mode int) + func (j TransmissionJoint) SetParam(parameter int, value float64) + func (j TransmissionJoint) SetRadius1(radius float64) + func (j TransmissionJoint) SetRadius2(radius float64) + func (j TransmissionJoint) SetRatio(ratio float64) + type TriCallback func(mesh TriMesh, other Geom, index int) bool + type TriMesh struct + func (t TriMesh) ClearTCCache() + func (t TriMesh) LastTransform() Matrix4 + func (t TriMesh) MeshData() TriMeshData + func (t TriMesh) Point(index int, u, v float64) Vector3 + func (t TriMesh) SetLastTransform(xform Matrix4) + func (t TriMesh) SetMeshData(data TriMeshData) + func (t TriMesh) SetTCEnabled(class int, isEnabled bool) + func (t TriMesh) SetTriCallback(cb TriCallback) + func (t TriMesh) SetTriRayCallback(cb TriRayCallback) + func (t TriMesh) TCEnabled(class int) bool + func (t TriMesh) TriCallback() TriCallback + func (t TriMesh) TriRayCallback() TriRayCallback + func (t TriMesh) Triangle(index int) (Vector3, Vector3, Vector3) + func (t TriMesh) TriangleCount() int + type TriMeshData uintptr + func NewTriMeshData() TriMeshData + func (t TriMeshData) Build(verts VertexList, tris TriVertexIndexList) + func (t TriMeshData) Destroy() + func (t TriMeshData) Preprocess() + func (t TriMeshData) Update() + type TriRayCallback func(mesh TriMesh, ray Ray, index int, u, v float64) bool + type TriVertexIndexList [][]uint32 + func NewTriVertexIndexList(size int, indices ...uint32) TriVertexIndexList + type UniversalJoint struct + func (j UniversalJoint) AddTorques(torque1, torque2 float64) + func (j UniversalJoint) Anchor() Vector3 + func (j UniversalJoint) Anchor2() Vector3 + func (j UniversalJoint) Angle1() float64 + func (j UniversalJoint) Angle1Rate() float64 + func (j UniversalJoint) Angle2() float64 + func (j UniversalJoint) Angle2Rate() float64 + func (j UniversalJoint) Angles() (float64, float64) + func (j UniversalJoint) Axis1() Vector3 + func (j UniversalJoint) Axis2() Vector3 + func (j UniversalJoint) Param(parameter int) float64 + func (j UniversalJoint) SetAnchor(pt Vector3) + func (j UniversalJoint) SetAxis1(axis Vector3) + func (j UniversalJoint) SetAxis1Offset(axis Vector3, offset1, offset2 float64) + func (j UniversalJoint) SetAxis2(axis Vector3) + func (j UniversalJoint) SetAxis2Offset(axis Vector3, offset1, offset2 float64) + func (j UniversalJoint) SetParam(parameter int, value float64) + type Vector []float64 + func NewVector(size, align int, vals ...float64) Vector + type Vector3 Vector + func NewVector3(vals ...float64) Vector3 + type Vector4 Vector + func NewVector4(vals ...float64) Vector4 + type VertexList Matrix + func NewVertexList(size int, vals ...float64) VertexList + type World uintptr + func NewWorld() World + func (w World) AngularDamping() float64 + func (w World) AngularDampingThreshold() float64 + func (w World) AutoDisable() bool + func (w World) AutoDisableAngularThreshold() float64 + func (w World) AutoDisableAverageSamplesCount() bool + func (w World) AutoDisableLinearThreshold() float64 + func (w World) AutoDisableSteps() int + func (w World) AutoDisableTime() float64 + func (w World) CFM() float64 + func (w World) CleanupWorkingMemory() + func (w World) ContactMaxCorrectingVelocity() float64 + func (w World) ContactSurfaceLayer() float64 + func (w World) Data() interface{} + func (w World) Destroy() + func (w World) ERP() float64 + func (w World) Gravity() Vector3 + func (w World) ImpulseToForce(stepSize float64, impulse Vector3) Vector3 + func (w World) LinearDamping() float64 + func (w World) LinearDampingThreshold() float64 + func (w World) MaxAngularSpeed() float64 + func (w World) NewAMotorJoint(group JointGroup) AMotorJoint + func (w World) NewBallJoint(group JointGroup) BallJoint + func (w World) NewBody() Body + func (w World) NewContactJoint(group JointGroup, contact *Contact) ContactJoint + func (w World) NewDBallJoint(group JointGroup) DBallJoint + func (w World) NewDHingeJoint(group JointGroup) DHingeJoint + func (w World) NewFixedJoint(group JointGroup) FixedJoint + func (w World) NewHinge2Joint(group JointGroup) Hinge2Joint + func (w World) NewHingeJoint(group JointGroup) HingeJoint + func (w World) NewLMotorJoint(group JointGroup) LMotorJoint + func (w World) NewNullJoint(group JointGroup) NullJoint + func (w World) NewPRJoint(group JointGroup) PRJoint + func (w World) NewPUJoint(group JointGroup) PUJoint + func (w World) NewPistonJoint(group JointGroup) PistonJoint + func (w World) NewPlane2DJoint(group JointGroup) Plane2DJoint + func (w World) NewSliderJoint(group JointGroup) SliderJoint + func (w World) NewTransmissionJoint(group JointGroup) TransmissionJoint + func (w World) NewUniversalJoint(group JointGroup) UniversalJoint + func (w World) QuickStep(stepSize float64) bool + func (w World) QuickStepNumIterations() int + func (w World) QuickStepW() float64 + func (w World) SetAngularDamping(scale float64) + func (w World) SetAngularDampingThreshold(threshold float64) + func (w World) SetAutoAutoDisableAverageSamplesCount(averageSamplesCount bool) + func (w World) SetAutoDisable(doAutoDisable bool) + func (w World) SetAutoDisableAngularThreshold(angularThreshold float64) + func (w World) SetAutoDisableLinearThreshold(linearThreshold float64) + func (w World) SetAutoDisableSteps(steps int) + func (w World) SetAutoDisableTime(time float64) + func (w World) SetCFM(cfm float64) + func (w World) SetContactMaxCorrectingVelocity(overRelaxation float64) + func (w World) SetContactSurfaceLayer(depth float64) + func (w World) SetData(data interface{}) + func (w World) SetERP(erp float64) + func (w World) SetGravity(grav Vector3) + func (w World) SetLinearDamping(scale float64) + func (w World) SetLinearDampingThreshold(threshold float64) + func (w World) SetMaxAngularSpeed(maxSpeed float64) + func (w World) SetQuickStepNumIterations(num int) + func (w World) SetQuickStepW(overRelaxation float64) + func (w World) SetStepIslandsProcessingMaxThreadCount(count int) + func (w World) Step(stepSize float64) bool + func (w World) StepIslandsProcessingMaxThreadCount() int + func (w World) UseSharedWorkingMemory(from World) bool