Versions in this module Expand all Collapse all v1 v1.0.2 Aug 24, 2018 v1.0.1 Oct 20, 2017 v1.0.0 Sep 20, 2017 Changes in this version + const B2DEBUG + const B2_DEBUG_SOLVER + const B2_aabbExtension + const B2_aabbMultiplier + const B2_angularSleepTolerance + const B2_angularSlop + const B2_baumgarte + const B2_epsilon + const B2_linearSleepTolerance + const B2_linearSlop + const B2_maxAngularCorrection + const B2_maxFloat + const B2_maxLinearCorrection + const B2_maxManifoldPoints + const B2_maxPolygonVertices + const B2_maxRotation + const B2_maxRotationSquared + const B2_maxSubSteps + const B2_maxTOIContacts + const B2_maxTranslation + const B2_maxTranslationSquared + const B2_nullFeature + const B2_nullNode + const B2_pi + const B2_polygonRadius + const B2_timeToSleep + const B2_toiBaugarte + const B2_velocityThreshold + const E_nullProxy + var B2BodyType = struct{ ... } + var B2Body_Flags = struct{ ... } + var B2ContactFeature_Type = struct{ ... } + var B2Contact_Flag = struct{ ... } + var B2EPAxis_Type = struct{ ... } + var B2EPCollider_VertexType = struct{ ... } + var B2JointType = struct{ ... } + var B2LimitState = struct{ ... } + var B2Manifold_Type = struct{ ... } + var B2PointState = struct{ ... } + var B2SeparationFunction_Type = struct{ ... } + var B2Shape_Type = struct{ ... } + var B2TOIOutput_State = struct{ ... } + var B2Vec2_zero = MakeB2Vec2(0, 0) + var B2World_Flags = struct{ ... } + var B2_toiCalls int + var B2_toiIters int + var B2_toiMaxIters int + var B2_toiMaxRootIters int + var B2_toiMaxTime float64 + var B2_toiRootIters int + var B2_toiTime float64 + func AbsInt(v int) int + func AddType(createFcn B2ContactCreateFcn, destroyFcn B2ContactDestroyFcn, type1 uint8, ...) + func B2Assert(a bool) + func B2ChainAndCircleContact_Destroy(contact B2ContactInterface) + func B2ChainAndPolygonContact_Destroy(contact B2ContactInterface) + func B2CircleContact_Destroy(contact B2ContactInterface) + func B2ClipSegmentToLine(vOut []B2ClipVertex, vIn []B2ClipVertex, normal B2Vec2, offset float64, ...) int + func B2CollideCircles(manifold *B2Manifold, circleA *B2CircleShape, xfA B2Transform, ...) + func B2CollideEdgeAndCircle(manifold *B2Manifold, edgeA *B2EdgeShape, xfA B2Transform, ...) + func B2CollideEdgeAndPolygon(manifold *B2Manifold, edgeA *B2EdgeShape, xfA B2Transform, ...) + func B2CollidePolygonAndCircle(manifold *B2Manifold, polygonA *B2PolygonShape, xfA B2Transform, ...) + func B2CollidePolygons(manifold *B2Manifold, polyA *B2PolygonShape, xfA B2Transform, ...) + func B2ContactDestroy(contact B2ContactInterface) + func B2ContactInitializeRegisters() + func B2ContactUpdate(contact B2ContactInterface, listener B2ContactListenerInterface) + func B2Distance(output *B2DistanceOutput, cache *B2SimplexCache, input *B2DistanceInput) + func B2EdgeAndCircleContact_Destroy(contact B2ContactInterface) + func B2EdgeAndPolygonContact_Destroy(contact B2ContactInterface) + func B2FindIncidentEdge(c []B2ClipVertex, poly1 *B2PolygonShape, xf1 B2Transform, edge1 int, ...) + func B2FindMaxSeparation(edgeIndex *int, poly1 *B2PolygonShape, xf1 B2Transform, poly2 *B2PolygonShape, ...) float64 + func B2FloatClamp(a, low, high float64) float64 + func B2GetPointStates(state1 *[B2_maxManifoldPoints]uint8, state2 *[B2_maxManifoldPoints]uint8, ...) + func B2InvSqrt(x float64) float64 + func B2IsPowerOfTwo(x uint32) bool + func B2IsValid(x float64) bool + func B2JointDestroy(joint B2JointInterface) + func B2MixFriction(friction1, friction2 float64) float64 + func B2MixRestitution(restitution1, restitution2 float64) float64 + func B2NextPowerOfTwo(x uint32) uint32 + func B2PairLessThan(pair1 B2Pair, pair2 B2Pair) bool + func B2PolygonAndCircleContact_Destroy(contact B2ContactInterface) + func B2PolygonContact_Destroy(contact B2ContactInterface) + func B2TestOverlapBoundingBoxes(a, b B2AABB) bool + func B2TestOverlapShapes(shapeA B2ShapeInterface, indexA int, shapeB B2ShapeInterface, indexB int, ...) bool + func B2TimeOfImpact(output *B2TOIOutput, input *B2TOIInput) + func B2Vec2Cross(a, b B2Vec2) float64 + func B2Vec2Distance(a, b B2Vec2) float64 + func B2Vec2DistanceSquared(a, b B2Vec2) float64 + func B2Vec2Dot(a, b B2Vec2) float64 + func B2Vec2Equals(a, b B2Vec2) bool + func B2Vec2NotEquals(a, b B2Vec2) bool + func B2Vec3Dot(a, b B2Vec3) float64 + func MaxInt(x, y int) int + func MinInt(x, y int) int + type B2AABB struct + LowerBound B2Vec2 + UpperBound B2Vec2 + func MakeB2AABB() B2AABB + func NewB2AABB() *B2AABB + func (bb *B2AABB) CombineInPlace(aabb B2AABB) + func (bb *B2AABB) CombineTwoInPlace(aabb1, aabb2 B2AABB) + func (bb B2AABB) Clone() B2AABB + func (bb B2AABB) Contains(aabb B2AABB) bool + func (bb B2AABB) GetCenter() B2Vec2 + func (bb B2AABB) GetExtents() B2Vec2 + func (bb B2AABB) GetPerimeter() float64 + func (bb B2AABB) IsValid() bool + func (bb B2AABB) RayCast(output *B2RayCastOutput, input B2RayCastInput) bool + type B2Body struct + M_I float64 + M_angularDamping float64 + M_angularVelocity float64 + M_contactList *B2ContactEdge + M_fixtureCount int + M_fixtureList *B2Fixture + M_flags uint32 + M_force B2Vec2 + M_gravityScale float64 + M_invI float64 + M_invMass float64 + M_islandIndex int + M_jointList *B2JointEdge + M_linearDamping float64 + M_linearVelocity B2Vec2 + M_mass float64 + M_next *B2Body + M_prev *B2Body + M_sleepTime float64 + M_sweep B2Sweep + M_torque float64 + M_type uint8 + M_userData interface{} + M_world *B2World + M_xf B2Transform + func NewB2Body(bd *B2BodyDef, world *B2World) *B2Body + func (body *B2Body) Advance(alpha float64) + func (body *B2Body) ApplyAngularImpulse(impulse float64, wake bool) + func (body *B2Body) ApplyForce(force B2Vec2, point B2Vec2, wake bool) + func (body *B2Body) ApplyForceToCenter(force B2Vec2, wake bool) + func (body *B2Body) ApplyLinearImpulse(impulse B2Vec2, point B2Vec2, wake bool) + func (body *B2Body) ApplyLinearImpulseToCenter(impulse B2Vec2, wake bool) + func (body *B2Body) ApplyTorque(torque float64, wake bool) + func (body *B2Body) CreateFixture(shape B2ShapeInterface, density float64) *B2Fixture + func (body *B2Body) CreateFixtureFromDef(def *B2FixtureDef) *B2Fixture + func (body *B2Body) DestroyFixture(fixture *B2Fixture) + func (body *B2Body) Dump() + func (body *B2Body) ResetMassData() + func (body *B2Body) SetActive(flag bool) + func (body *B2Body) SetAngularDamping(angularDamping float64) + func (body *B2Body) SetAngularVelocity(w float64) + func (body *B2Body) SetAwake(flag bool) + func (body *B2Body) SetBullet(flag bool) + func (body *B2Body) SetFixedRotation(flag bool) + func (body *B2Body) SetGravityScale(scale float64) + func (body *B2Body) SetLinearDamping(linearDamping float64) + func (body *B2Body) SetLinearVelocity(v B2Vec2) + func (body *B2Body) SetMassData(massData *B2MassData) + func (body *B2Body) SetSleepingAllowed(flag bool) + func (body *B2Body) SetTransform(position B2Vec2, angle float64) + func (body *B2Body) SetType(bodytype uint8) + func (body *B2Body) SetUserData(data interface{}) + func (body *B2Body) SynchronizeFixtures() + func (body *B2Body) SynchronizeTransform() + func (body B2Body) GetAngle() float64 + func (body B2Body) GetAngularDamping() float64 + func (body B2Body) GetAngularVelocity() float64 + func (body B2Body) GetContactList() *B2ContactEdge + func (body B2Body) GetFixtureList() *B2Fixture + func (body B2Body) GetGravityScale() float64 + func (body B2Body) GetInertia() float64 + func (body B2Body) GetJointList() *B2JointEdge + func (body B2Body) GetLinearDamping() float64 + func (body B2Body) GetLinearVelocity() B2Vec2 + func (body B2Body) GetLinearVelocityFromLocalPoint(localPoint B2Vec2) B2Vec2 + func (body B2Body) GetLinearVelocityFromWorldPoint(worldPoint B2Vec2) B2Vec2 + func (body B2Body) GetLocalCenter() B2Vec2 + func (body B2Body) GetLocalPoint(worldPoint B2Vec2) B2Vec2 + func (body B2Body) GetLocalVector(worldVector B2Vec2) B2Vec2 + func (body B2Body) GetMass() float64 + func (body B2Body) GetMassData(data *B2MassData) + func (body B2Body) GetNext() *B2Body + func (body B2Body) GetPosition() B2Vec2 + func (body B2Body) GetTransform() B2Transform + func (body B2Body) GetType() uint8 + func (body B2Body) GetUserData() interface{} + func (body B2Body) GetWorld() *B2World + func (body B2Body) GetWorldCenter() B2Vec2 + func (body B2Body) GetWorldPoint(localPoint B2Vec2) B2Vec2 + func (body B2Body) GetWorldVector(localVector B2Vec2) B2Vec2 + func (body B2Body) IsActive() bool + func (body B2Body) IsAwake() bool + func (body B2Body) IsBullet() bool + func (body B2Body) IsFixedRotation() bool + func (body B2Body) IsSleepingAllowed() bool + func (body B2Body) ShouldCollide(other *B2Body) bool + type B2BodyDef struct + Active bool + AllowSleep bool + Angle float64 + AngularDamping float64 + AngularVelocity float64 + Awake bool + Bullet bool + FixedRotation bool + GravityScale float64 + LinearDamping float64 + LinearVelocity B2Vec2 + Position B2Vec2 + Type uint8 + UserData interface{} + func MakeB2BodyDef() B2BodyDef + func NewB2BodyDef() *B2BodyDef + type B2BroadPhase struct + M_moveBuffer []int + M_moveCapacity int + M_moveCount int + M_pairBuffer []B2Pair + M_pairCapacity int + M_pairCount int + M_proxyCount int + M_queryProxyId int + M_tree B2DynamicTree + func MakeB2BroadPhase() B2BroadPhase + func (bp *B2BroadPhase) BufferMove(proxyId int) + func (bp *B2BroadPhase) CreateProxy(aabb B2AABB, userData interface{}) int + func (bp *B2BroadPhase) DestroyProxy(proxyId int) + func (bp *B2BroadPhase) MoveProxy(proxyId int, aabb B2AABB, displacement B2Vec2) + func (bp *B2BroadPhase) Query(callback B2TreeQueryCallback, aabb B2AABB) + func (bp *B2BroadPhase) QueryCallback(proxyId int) bool + func (bp *B2BroadPhase) RayCast(callback B2TreeRayCastCallback, input B2RayCastInput) + func (bp *B2BroadPhase) ShiftOrigin(newOrigin B2Vec2) + func (bp *B2BroadPhase) TouchProxy(proxyId int) + func (bp *B2BroadPhase) UnBufferMove(proxyId int) + func (bp *B2BroadPhase) UpdatePairs(addPairCallback B2BroadPhaseAddPairCallback) + func (bp B2BroadPhase) GetFatAABB(proxyId int) B2AABB + func (bp B2BroadPhase) GetProxyCount() int + func (bp B2BroadPhase) GetTreeBalance() int + func (bp B2BroadPhase) GetTreeHeight() int + func (bp B2BroadPhase) GetTreeQuality() float64 + func (bp B2BroadPhase) GetUserData(proxyId int) interface{} + func (bp B2BroadPhase) TestOverlap(proxyIdA int, proxyIdB int) bool + type B2BroadPhaseAddPairCallback func(userDataA interface{}, userDataB interface{}) + type B2BroadPhaseQueryCallback func(fixture *B2Fixture) bool + type B2ChainAndCircleContact struct + func (contact *B2ChainAndCircleContact) Evaluate(manifold *B2Manifold, xfA B2Transform, xfB B2Transform) + type B2ChainAndPolygonContact struct + func (contact *B2ChainAndPolygonContact) Evaluate(manifold *B2Manifold, xfA B2Transform, xfB B2Transform) + type B2ChainShape struct + M_count int + M_hasNextVertex bool + M_hasPrevVertex bool + M_nextVertex B2Vec2 + M_prevVertex B2Vec2 + M_vertices []B2Vec2 + func MakeB2ChainShape() B2ChainShape + func (chain *B2ChainShape) Clear() + func (chain *B2ChainShape) CreateChain(vertices []B2Vec2, count int) + func (chain *B2ChainShape) CreateLoop(vertices []B2Vec2, count int) + func (chain *B2ChainShape) Destroy() + func (chain *B2ChainShape) SetNextVertex(nextVertex B2Vec2) + func (chain *B2ChainShape) SetPrevVertex(prevVertex B2Vec2) + func (chain B2ChainShape) Clone() B2ShapeInterface + func (chain B2ChainShape) ComputeAABB(aabb *B2AABB, xf B2Transform, childIndex int) + func (chain B2ChainShape) ComputeMass(massData *B2MassData, density float64) + func (chain B2ChainShape) GetChildCount() int + func (chain B2ChainShape) GetChildEdge(edge *B2EdgeShape, index int) + func (chain B2ChainShape) RayCast(output *B2RayCastOutput, input B2RayCastInput, xf B2Transform, childIndex int) bool + func (chain B2ChainShape) TestPoint(xf B2Transform, p B2Vec2) bool + type B2CircleContact struct + func (contact *B2CircleContact) Evaluate(manifold *B2Manifold, xfA B2Transform, xfB B2Transform) + type B2CircleShape struct + M_p B2Vec2 + func MakeB2CircleShape() B2CircleShape + func NewB2CircleShape() *B2CircleShape + func (shape B2CircleShape) Clone() B2ShapeInterface + func (shape B2CircleShape) ComputeAABB(aabb *B2AABB, transform B2Transform, childIndex int) + func (shape B2CircleShape) ComputeMass(massData *B2MassData, density float64) + func (shape B2CircleShape) Destroy() + func (shape B2CircleShape) GetChildCount() int + func (shape B2CircleShape) RayCast(output *B2RayCastOutput, input B2RayCastInput, transform B2Transform, ...) bool + func (shape B2CircleShape) TestPoint(transform B2Transform, p B2Vec2) bool + type B2ClipVertex struct + Id B2ContactID + V B2Vec2 + type B2Contact struct + M_fixtureA *B2Fixture + M_fixtureB *B2Fixture + M_flags uint32 + M_friction float64 + M_indexA int + M_indexB int + M_manifold *B2Manifold + M_next B2ContactInterface + M_nodeA *B2ContactEdge + M_nodeB *B2ContactEdge + M_prev B2ContactInterface + M_restitution float64 + M_tangentSpeed float64 + M_toi float64 + M_toiCount int + func MakeB2Contact(fA *B2Fixture, indexA int, fB *B2Fixture, indexB int) B2Contact + func (contact *B2Contact) FlagForFiltering() + func (contact *B2Contact) ResetFriction() + func (contact *B2Contact) ResetRestitution() + func (contact *B2Contact) SetChildIndexA(index int) + func (contact *B2Contact) SetChildIndexB(index int) + func (contact *B2Contact) SetEnabled(flag bool) + func (contact *B2Contact) SetFixtureA(fixture *B2Fixture) + func (contact *B2Contact) SetFixtureB(fixture *B2Fixture) + func (contact *B2Contact) SetFlags(flags uint32) + func (contact *B2Contact) SetFriction(friction float64) + func (contact *B2Contact) SetManifold(manifold *B2Manifold) + func (contact *B2Contact) SetNext(next B2ContactInterface) + func (contact *B2Contact) SetNodeA(node *B2ContactEdge) + func (contact *B2Contact) SetNodeB(node *B2ContactEdge) + func (contact *B2Contact) SetPrev(prev B2ContactInterface) + func (contact *B2Contact) SetRestitution(restitution float64) + func (contact *B2Contact) SetTOI(toi float64) + func (contact *B2Contact) SetTOICount(toiCount int) + func (contact *B2Contact) SetTangentSpeed(speed float64) + func (contact B2Contact) GetChildIndexA() int + func (contact B2Contact) GetChildIndexB() int + func (contact B2Contact) GetFixtureA() *B2Fixture + func (contact B2Contact) GetFixtureB() *B2Fixture + func (contact B2Contact) GetFlags() uint32 + func (contact B2Contact) GetFriction() float64 + func (contact B2Contact) GetManifold() *B2Manifold + func (contact B2Contact) GetNext() B2ContactInterface + func (contact B2Contact) GetNodeA() *B2ContactEdge + func (contact B2Contact) GetNodeB() *B2ContactEdge + func (contact B2Contact) GetPrev() B2ContactInterface + func (contact B2Contact) GetRestitution() float64 + func (contact B2Contact) GetTOI() float64 + func (contact B2Contact) GetTOICount() int + func (contact B2Contact) GetTangentSpeed() float64 + func (contact B2Contact) GetWorldManifold(worldManifold *B2WorldManifold) + func (contact B2Contact) IsEnabled() bool + func (contact B2Contact) IsTouching() bool + type B2ContactCreateFcn func(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + type B2ContactDestroyFcn func(contact B2ContactInterface) + type B2ContactEdge struct + Contact B2ContactInterface + Next *B2ContactEdge + Other *B2Body + Prev *B2ContactEdge + func NewB2ContactEdge() *B2ContactEdge + type B2ContactFeature struct + IndexA uint8 + IndexB uint8 + TypeA uint8 + TypeB uint8 + func MakeB2ContactFeature() B2ContactFeature + type B2ContactFilter struct + func (cf *B2ContactFilter) ShouldCollide(fixtureA *B2Fixture, fixtureB *B2Fixture) bool + type B2ContactFilterInterface interface + ShouldCollide func(fixtureA *B2Fixture, fixtureB *B2Fixture) bool + type B2ContactID B2ContactFeature + func (v B2ContactID) Key() uint32 + func (v B2ContactID) SetKey(key uint32) + type B2ContactImpulse struct + Count int + NormalImpulses [B2_maxManifoldPoints]float64 + TangentImpulses [B2_maxManifoldPoints]float64 + func MakeB2ContactImpulse() B2ContactImpulse + type B2ContactInterface interface + Evaluate func(manifold *B2Manifold, xfA B2Transform, xfB B2Transform) + FlagForFiltering func() + GetChildIndexA func() int + GetChildIndexB func() int + GetFixtureA func() *B2Fixture + GetFixtureB func() *B2Fixture + GetFlags func() uint32 + GetFriction func() float64 + GetManifold func() *B2Manifold + GetNext func() B2ContactInterface + GetNodeA func() *B2ContactEdge + GetNodeB func() *B2ContactEdge + GetPrev func() B2ContactInterface + GetRestitution func() float64 + GetTOI func() float64 + GetTOICount func() int + GetTangentSpeed func() float64 + GetWorldManifold func(worldManifold *B2WorldManifold) + IsEnabled func() bool + IsTouching func() bool + ResetFriction func() + ResetRestitution func() + SetChildIndexA func(index int) + SetChildIndexB func(index int) + SetEnabled func(bool) + SetFixtureA func(fixture *B2Fixture) + SetFixtureB func(fixture *B2Fixture) + SetFlags func(flags uint32) + SetFriction func(friction float64) + SetManifold func(manifold *B2Manifold) + SetNext func(prev B2ContactInterface) + SetNodeA func(node *B2ContactEdge) + SetNodeB func(node *B2ContactEdge) + SetPrev func(prev B2ContactInterface) + SetRestitution func(restitution float64) + SetTOI func(toiCount float64) + SetTOICount func(toiCount int) + SetTangentSpeed func(tangentSpeed float64) + func B2ChainAndCircleContact_Create(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + func B2ChainAndPolygonContact_Create(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + func B2CircleContact_Create(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + func B2ContactFactory(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + func B2EdgeAndCircleContact_Create(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + func B2EdgeAndPolygonContact_Create(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + func B2PolygonAndCircleContact_Create(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + func B2PolygonContact_Create(fixtureA *B2Fixture, indexA int, fixtureB *B2Fixture, indexB int) B2ContactInterface + type B2ContactListenerInterface interface + BeginContact func(contact B2ContactInterface) + EndContact func(contact B2ContactInterface) + PostSolve func(contact B2ContactInterface, impulse *B2ContactImpulse) + PreSolve func(contact B2ContactInterface, oldManifold B2Manifold) + type B2ContactManager struct + M_broadPhase B2BroadPhase + M_contactCount int + M_contactFilter B2ContactFilterInterface + M_contactList B2ContactInterface + M_contactListener B2ContactListenerInterface + func MakeB2ContactManager() B2ContactManager + func NewB2ContactManager() *B2ContactManager + func (mgr *B2ContactManager) AddPair(proxyUserDataA interface{}, proxyUserDataB interface{}) + func (mgr *B2ContactManager) Collide() + func (mgr *B2ContactManager) Destroy(c B2ContactInterface) + func (mgr *B2ContactManager) FindNewContacts() + type B2ContactPositionConstraint struct + IndexA int + IndexB int + InvIA float64 + InvIB float64 + InvMassA float64 + InvMassB float64 + LocalCenterA B2Vec2 + LocalCenterB B2Vec2 + LocalNormal B2Vec2 + LocalPoint B2Vec2 + LocalPoints [B2_maxManifoldPoints]B2Vec2 + PointCount int + RadiusA float64 + RadiusB float64 + Type uint8 + type B2ContactRegister struct + CreateFcn B2ContactCreateFcn + DestroyFcn B2ContactDestroyFcn + Primary bool + type B2ContactSolver struct + M_contacts []B2ContactInterface + M_count int + M_positionConstraints []B2ContactPositionConstraint + M_positions []B2Position + M_step B2TimeStep + M_velocities []B2Velocity + M_velocityConstraints []B2ContactVelocityConstraint + func MakeB2ContactSolver(def *B2ContactSolverDef) B2ContactSolver + func (solver *B2ContactSolver) Destroy() + func (solver *B2ContactSolver) InitializeVelocityConstraints() + func (solver *B2ContactSolver) SolvePositionConstraints() bool + func (solver *B2ContactSolver) SolveTOIPositionConstraints(toiIndexA int, toiIndexB int) bool + func (solver *B2ContactSolver) SolveVelocityConstraints() + func (solver *B2ContactSolver) StoreImpulses() + func (solver *B2ContactSolver) WarmStart() + type B2ContactSolverDef struct + Contacts []B2ContactInterface + Count int + Positions []B2Position + Step B2TimeStep + Velocities []B2Velocity + func MakeB2ContactSolverDef() B2ContactSolverDef + type B2ContactVelocityConstraint struct + ContactIndex int + Friction float64 + IndexA int + IndexB int + InvIA float64 + InvIB float64 + InvMassA float64 + InvMassB float64 + K B2Mat22 + Normal B2Vec2 + NormalMass B2Mat22 + PointCount int + Points [B2_maxManifoldPoints]B2VelocityConstraintPoint + Restitution float64 + TangentSpeed float64 + type B2DestructionListenerInterface interface + SayGoodbyeToFixture func(fixture *B2Fixture) + SayGoodbyeToJoint func(joint B2JointInterface) + type B2DistanceInput struct + ProxyA B2DistanceProxy + ProxyB B2DistanceProxy + TransformA B2Transform + TransformB B2Transform + UseRadii bool + func MakeB2DistanceInput() B2DistanceInput + func NewB2DistanceInput() *B2DistanceInput + type B2DistanceJoint struct + M_bias float64 + M_dampingRatio float64 + M_frequencyHz float64 + M_gamma float64 + M_impulse float64 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_length float64 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_mass float64 + M_rA B2Vec2 + M_rB B2Vec2 + M_u B2Vec2 + func MakeB2DistanceJoint(def *B2DistanceJointDef) *B2DistanceJoint + func (joint *B2DistanceJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2DistanceJoint) SetDampingRatio(ratio float64) + func (joint *B2DistanceJoint) SetFrequency(hz float64) + func (joint *B2DistanceJoint) SetLength(length float64) + func (joint *B2DistanceJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2DistanceJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2DistanceJoint) Dump() + func (joint B2DistanceJoint) GetAnchorA() B2Vec2 + func (joint B2DistanceJoint) GetAnchorB() B2Vec2 + func (joint B2DistanceJoint) GetDampingRatio() float64 + func (joint B2DistanceJoint) GetFrequency() float64 + func (joint B2DistanceJoint) GetLength() float64 + func (joint B2DistanceJoint) GetLocalAnchorA() B2Vec2 + func (joint B2DistanceJoint) GetLocalAnchorB() B2Vec2 + func (joint B2DistanceJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2DistanceJoint) GetReactionTorque(inv_dt float64) float64 + type B2DistanceJointDef struct + DampingRatio float64 + FrequencyHz float64 + Length float64 + LocalAnchorA B2Vec2 + LocalAnchorB B2Vec2 + func MakeB2DistanceJointDef() B2DistanceJointDef + func (joint *B2DistanceJointDef) Initialize(b1 *B2Body, b2 *B2Body, anchor1 B2Vec2, anchor2 B2Vec2) + type B2DistanceOutput struct + Distance float64 + Iterations int + PointA B2Vec2 + PointB B2Vec2 + func MakeB2DistanceOutput() B2DistanceOutput + func NewB2DistanceOutput() *B2DistanceOutput + type B2DistanceProxy struct + M_buffer [2]B2Vec2 + M_count int + M_radius float64 + M_vertices []B2Vec2 + func MakeB2DistanceProxy() B2DistanceProxy + func NewB2DistanceProxy() *B2DistanceProxy + func (p *B2DistanceProxy) Set(shape B2ShapeInterface, index int) + func (p B2DistanceProxy) GetSupport(d B2Vec2) int + func (p B2DistanceProxy) GetSupportVertex(d B2Vec2) B2Vec2 + func (p B2DistanceProxy) GetVertex(index int) B2Vec2 + func (p B2DistanceProxy) GetVertexCount() int + type B2DynamicTree struct + M_freeList int + M_insertionCount int + M_nodeCapacity int + M_nodeCount int + M_nodes []B2TreeNode + M_path int + M_root int + func MakeB2DynamicTree() B2DynamicTree + func (tree *B2DynamicTree) AllocateNode() int + func (tree *B2DynamicTree) Balance(iA int) int + func (tree *B2DynamicTree) CreateProxy(aabb B2AABB, userData interface{}) int + func (tree *B2DynamicTree) DestroyProxy(proxyId int) + func (tree *B2DynamicTree) FreeNode(nodeId int) + func (tree *B2DynamicTree) InsertLeaf(leaf int) + func (tree *B2DynamicTree) MoveProxy(proxyId int, aabb B2AABB, displacement B2Vec2) bool + func (tree *B2DynamicTree) Query(queryCallback B2TreeQueryCallback, aabb B2AABB) + func (tree *B2DynamicTree) RebuildBottomUp() + func (tree *B2DynamicTree) RemoveLeaf(leaf int) + func (tree *B2DynamicTree) ShiftOrigin(newOrigin B2Vec2) + func (tree B2DynamicTree) ComputeHeight(nodeId int) int + func (tree B2DynamicTree) ComputeTotalHeight() int + func (tree B2DynamicTree) GetAreaRatio() float64 + func (tree B2DynamicTree) GetFatAABB(proxyId int) B2AABB + func (tree B2DynamicTree) GetHeight() int + func (tree B2DynamicTree) GetMaxBalance() int + func (tree B2DynamicTree) GetUserData(proxyId int) interface{} + func (tree B2DynamicTree) RayCast(rayCastCallback B2TreeRayCastCallback, input B2RayCastInput) + func (tree B2DynamicTree) Validate() + func (tree B2DynamicTree) ValidateMetrics(index int) + func (tree B2DynamicTree) ValidateStructure(index int) + type B2EPAxis struct + Index int + Separation float64 + Type uint8 + func MakeB2EPAxis() B2EPAxis + type B2EPCollider struct + M_centroidB B2Vec2 + M_front bool + M_lowerLimit B2Vec2 + M_normal B2Vec2 + M_normal0 B2Vec2 + M_normal1 B2Vec2 + M_normal2 B2Vec2 + M_polygonB B2TempPolygon + M_radius float64 + M_type1 uint8 + M_type2 uint8 + M_upperLimit B2Vec2 + M_v0 B2Vec2 + M_v1 B2Vec2 + M_v2 B2Vec2 + M_v3 B2Vec2 + M_xf B2Transform + func MakeB2EPCollider() B2EPCollider + func (collider *B2EPCollider) Collide(manifold *B2Manifold, edgeA *B2EdgeShape, xfA B2Transform, ...) + func (collider *B2EPCollider) ComputeEdgeSeparation() B2EPAxis + func (collider *B2EPCollider) ComputePolygonSeparation() B2EPAxis + type B2EdgeAndCircleContact struct + func (contact *B2EdgeAndCircleContact) Evaluate(manifold *B2Manifold, xfA B2Transform, xfB B2Transform) + type B2EdgeAndPolygonContact struct + func (contact *B2EdgeAndPolygonContact) Evaluate(manifold *B2Manifold, xfA B2Transform, xfB B2Transform) + type B2EdgeShape struct + M_hasVertex0 bool + M_hasVertex3 bool + M_vertex0 B2Vec2 + M_vertex1 B2Vec2 + M_vertex2 B2Vec2 + M_vertex3 B2Vec2 + func MakeB2EdgeShape() B2EdgeShape + func NewB2EdgeShape() *B2EdgeShape + func (edge *B2EdgeShape) Destroy() + func (edge *B2EdgeShape) Set(v1 B2Vec2, v2 B2Vec2) + func (edge B2EdgeShape) Clone() B2ShapeInterface + func (edge B2EdgeShape) ComputeAABB(aabb *B2AABB, xf B2Transform, childIndex int) + func (edge B2EdgeShape) ComputeMass(massData *B2MassData, density float64) + func (edge B2EdgeShape) GetChildCount() int + func (edge B2EdgeShape) RayCast(output *B2RayCastOutput, input B2RayCastInput, xf B2Transform, childIndex int) bool + func (edge B2EdgeShape) TestPoint(xf B2Transform, p B2Vec2) bool + type B2Filter struct + CategoryBits uint16 + GroupIndex int16 + MaskBits uint16 + func MakeB2Filter() B2Filter + type B2Fixture struct + M_body *B2Body + M_density float64 + M_filter B2Filter + M_friction float64 + M_isSensor bool + M_next *B2Fixture + M_proxies []B2FixtureProxy + M_proxyCount int + M_restitution float64 + M_shape B2ShapeInterface + M_userData interface{} + func MakeB2Fixture() B2Fixture + func NewB2Fixture() *B2Fixture + func (fix *B2Fixture) Create(body *B2Body, def *B2FixtureDef) + func (fix *B2Fixture) CreateProxies(broadPhase *B2BroadPhase, xf B2Transform) + func (fix *B2Fixture) Destroy() + func (fix *B2Fixture) DestroyProxies(broadPhase *B2BroadPhase) + func (fix *B2Fixture) Dump(bodyIndex int) + func (fix *B2Fixture) Refilter() + func (fix *B2Fixture) SetDensity(density float64) + func (fix *B2Fixture) SetFilterData(filter B2Filter) + func (fix *B2Fixture) SetFriction(friction float64) + func (fix *B2Fixture) SetRestitution(restitution float64) + func (fix *B2Fixture) SetSensor(sensor bool) + func (fix *B2Fixture) SetUserData(data interface{}) + func (fix *B2Fixture) Synchronize(broadPhase *B2BroadPhase, transform1 B2Transform, transform2 B2Transform) + func (fix B2Fixture) GetAABB(childIndex int) B2AABB + func (fix B2Fixture) GetBody() *B2Body + func (fix B2Fixture) GetDensity() float64 + func (fix B2Fixture) GetFilterData() B2Filter + func (fix B2Fixture) GetFriction() float64 + func (fix B2Fixture) GetMassData(massData *B2MassData) + func (fix B2Fixture) GetNext() *B2Fixture + func (fix B2Fixture) GetRestitution() float64 + func (fix B2Fixture) GetShape() B2ShapeInterface + func (fix B2Fixture) GetType() uint8 + func (fix B2Fixture) GetUserData() interface{} + func (fix B2Fixture) IsSensor() bool + func (fix B2Fixture) RayCast(output *B2RayCastOutput, input B2RayCastInput, childIndex int) bool + func (fix B2Fixture) TestPoint(p B2Vec2) bool + type B2FixtureDef struct + Density float64 + Filter B2Filter + Friction float64 + IsSensor bool + Restitution float64 + Shape B2ShapeInterface + UserData interface{} + func MakeB2FixtureDef() B2FixtureDef + type B2FixtureProxy struct + Aabb B2AABB + ChildIndex int + Fixture *B2Fixture + ProxyId int + type B2FrictionJoint struct + M_angularImpulse float64 + M_angularMass float64 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_linearImpulse B2Vec2 + M_linearMass B2Mat22 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_maxForce float64 + M_maxTorque float64 + M_rA B2Vec2 + M_rB B2Vec2 + func MakeB2FrictionJoint(def *B2FrictionJointDef) *B2FrictionJoint + func (joint *B2FrictionJoint) Dump() + func (joint *B2FrictionJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2FrictionJoint) SetMaxForce(force float64) + func (joint *B2FrictionJoint) SetMaxTorque(torque float64) + func (joint *B2FrictionJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2FrictionJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2FrictionJoint) GetAnchorA() B2Vec2 + func (joint B2FrictionJoint) GetAnchorB() B2Vec2 + func (joint B2FrictionJoint) GetLocalAnchorA() B2Vec2 + func (joint B2FrictionJoint) GetLocalAnchorB() B2Vec2 + func (joint B2FrictionJoint) GetMaxForce() float64 + func (joint B2FrictionJoint) GetMaxTorque() float64 + func (joint B2FrictionJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2FrictionJoint) GetReactionTorque(inv_dt float64) float64 + type B2FrictionJointDef struct + LocalAnchorA B2Vec2 + LocalAnchorB B2Vec2 + MaxForce float64 + MaxTorque float64 + func MakeB2FrictionJointDef() B2FrictionJointDef + func (joint *B2FrictionJointDef) Initialize(bA *B2Body, bB *B2Body, anchor B2Vec2) + type B2GearJoint struct + M_JvAC B2Vec2 + M_JvBD B2Vec2 + M_JwA float64 + M_JwB float64 + M_JwC float64 + M_JwD float64 + M_bodyC *B2Body + M_bodyD *B2Body + M_constant float64 + M_iA float64 + M_iB float64 + M_iC float64 + M_iD float64 + M_impulse float64 + M_indexA int + M_indexB int + M_indexC int + M_indexD int + M_joint1 B2JointInterface + M_joint2 B2JointInterface + M_lcA B2Vec2 + M_lcB B2Vec2 + M_lcC B2Vec2 + M_lcD B2Vec2 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localAnchorC B2Vec2 + M_localAnchorD B2Vec2 + M_localAxisC B2Vec2 + M_localAxisD B2Vec2 + M_mA float64 + M_mB float64 + M_mC float64 + M_mD float64 + M_mass float64 + M_ratio float64 + M_referenceAngleA float64 + M_referenceAngleB float64 + M_typeA uint8 + M_typeB uint8 + func MakeB2GearJoint(def *B2GearJointDef) *B2GearJoint + func (joint *B2GearJoint) Dump() + func (joint *B2GearJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2GearJoint) SetRatio(ratio float64) + func (joint *B2GearJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2GearJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2GearJoint) GetAnchorA() B2Vec2 + func (joint B2GearJoint) GetAnchorB() B2Vec2 + func (joint B2GearJoint) GetJoint1() B2JointInterface + func (joint B2GearJoint) GetJoint2() B2JointInterface + func (joint B2GearJoint) GetRatio() float64 + func (joint B2GearJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2GearJoint) GetReactionTorque(inv_dt float64) float64 + type B2GearJointDef struct + Joint1 B2JointInterface + Joint2 B2JointInterface + Ratio float64 + func MakeB2GearJointDef() B2GearJointDef + type B2GrowableStack struct + func NewB2GrowableStack() *B2GrowableStack + func (s *B2GrowableStack) Pop() (value interface{}) + func (s *B2GrowableStack) Push(value interface{}) + func (s B2GrowableStack) GetCount() int + type B2Island struct + M_bodies []*B2Body + M_bodyCapacity int + M_bodyCount int + M_contactCapacity int + M_contactCount int + M_contacts []B2ContactInterface + M_jointCapacity int + M_jointCount int + M_joints []B2JointInterface + M_listener B2ContactListenerInterface + M_positions []B2Position + M_velocities []B2Velocity + func MakeB2Island(bodyCapacity int, contactCapacity int, jointCapacity int, ...) B2Island + func (island *B2Island) Add(joint B2JointInterface) + func (island *B2Island) AddBody(body *B2Body) + func (island *B2Island) AddContact(contact B2ContactInterface) + func (island *B2Island) Clear() + func (island *B2Island) Destroy() + func (island *B2Island) Report(constraints []B2ContactVelocityConstraint) + func (island *B2Island) Solve(profile *B2Profile, step B2TimeStep, gravity B2Vec2, allowSleep bool) + func (island *B2Island) SolveTOI(subStep B2TimeStep, toiIndexA int, toiIndexB int) + type B2Jacobian struct + AngularA float64 + AngularB float64 + Linear B2Vec2 + type B2Joint struct + M_bodyA *B2Body + M_bodyB *B2Body + M_collideConnected bool + M_edgeA *B2JointEdge + M_edgeB *B2JointEdge + M_index int + M_islandFlag bool + M_next B2JointInterface + M_prev B2JointInterface + M_type uint8 + M_userData interface{} + func MakeB2Joint(def B2JointDefInterface) *B2Joint + func (j *B2Joint) Destroy() + func (j *B2Joint) InitVelocityConstraints(data B2SolverData) + func (j *B2Joint) SetBodyA(body *B2Body) + func (j *B2Joint) SetBodyB(body *B2Body) + func (j *B2Joint) SetCollideConnected(flag bool) + func (j *B2Joint) SetEdgeA(edge *B2JointEdge) + func (j *B2Joint) SetEdgeB(edge *B2JointEdge) + func (j *B2Joint) SetIndex(index int) + func (j *B2Joint) SetIslandFlag(flag bool) + func (j *B2Joint) SetNext(next B2JointInterface) + func (j *B2Joint) SetPrev(prev B2JointInterface) + func (j *B2Joint) SetType(t uint8) + func (j *B2Joint) SetUserData(data interface{}) + func (j *B2Joint) SolvePositionConstraints(data B2SolverData) bool + func (j *B2Joint) SolveVelocityConstraints(data B2SolverData) + func (j B2Joint) Dump() + func (j B2Joint) GetBodyA() *B2Body + func (j B2Joint) GetBodyB() *B2Body + func (j B2Joint) GetEdgeA() *B2JointEdge + func (j B2Joint) GetEdgeB() *B2JointEdge + func (j B2Joint) GetIndex() int + func (j B2Joint) GetIslandFlag() bool + func (j B2Joint) GetNext() B2JointInterface + func (j B2Joint) GetPrev() B2JointInterface + func (j B2Joint) GetType() uint8 + func (j B2Joint) GetUserData() interface{} + func (j B2Joint) IsActive() bool + func (j B2Joint) IsCollideConnected() bool + func (j B2Joint) ShiftOrigin(newOrigin B2Vec2) + type B2JointDef struct + BodyA *B2Body + BodyB *B2Body + CollideConnected bool + Type uint8 + UserData interface{} + func MakeB2JointDef() B2JointDef + func (def *B2JointDef) SetBodyA(body *B2Body) + func (def *B2JointDef) SetBodyB(body *B2Body) + func (def *B2JointDef) SetCollideConnected(flag bool) + func (def *B2JointDef) SetType(t uint8) + func (def *B2JointDef) SetUserData(userdata interface{}) + func (def B2JointDef) GetBodyA() *B2Body + func (def B2JointDef) GetBodyB() *B2Body + func (def B2JointDef) GetType() uint8 + func (def B2JointDef) GetUserData() interface{} + func (def B2JointDef) IsCollideConnected() bool + type B2JointDefInterface interface + GetBodyA func() *B2Body + GetBodyB func() *B2Body + GetType func() uint8 + GetUserData func() interface{} + IsCollideConnected func() bool + SetBodyA func(body *B2Body) + SetBodyB func(body *B2Body) + SetCollideConnected func(flag bool) + SetType func(t uint8) + SetUserData func(userdata interface{}) + type B2JointEdge struct + Joint B2JointInterface + Next *B2JointEdge + Other *B2Body + Prev *B2JointEdge + type B2JointInterface interface + Destroy func() + Dump func() + GetBodyA func() *B2Body + GetBodyB func() *B2Body + GetEdgeA func() *B2JointEdge + GetEdgeB func() *B2JointEdge + GetIndex func() int + GetIslandFlag func() bool + GetNext func() B2JointInterface + GetPrev func() B2JointInterface + GetType func() uint8 + GetUserData func() interface{} + InitVelocityConstraints func(data B2SolverData) + IsActive func() bool + IsCollideConnected func() bool + SetBodyA func(body *B2Body) + SetBodyB func(body *B2Body) + SetCollideConnected func(flag bool) + SetEdgeA func(edge *B2JointEdge) + SetEdgeB func(edge *B2JointEdge) + SetIndex func(index int) + SetIslandFlag func(flag bool) + SetNext func(next B2JointInterface) + SetPrev func(prev B2JointInterface) + SetType func(t uint8) + SetUserData func(data interface{}) + ShiftOrigin func(newOrigin B2Vec2) + SolvePositionConstraints func(data B2SolverData) bool + SolveVelocityConstraints func(data B2SolverData) + func B2JointCreate(def B2JointDefInterface) B2JointInterface + type B2Manifold struct + LocalNormal B2Vec2 + LocalPoint B2Vec2 + PointCount int + Points [B2_maxManifoldPoints]B2ManifoldPoint + Type uint8 + func NewB2Manifold() *B2Manifold + type B2ManifoldPoint struct + Id B2ContactID + LocalPoint B2Vec2 + NormalImpulse float64 + TangentImpulse float64 + type B2MassData struct + Center B2Vec2 + I float64 + Mass float64 + func MakeMassData() B2MassData + func NewMassData() *B2MassData + type B2Mat22 struct + Ex B2Vec2 + Ey B2Vec2 + func B2Mat22Abs(A B2Mat22) B2Mat22 + func B2Mat22Add(A, B B2Mat22) B2Mat22 + func B2Mat22Mul(A, B B2Mat22) B2Mat22 + func B2Mat22MulT(A, B B2Mat22) B2Mat22 + func MakeB2Mat22() B2Mat22 + func MakeB2Mat22FromColumns(c1, c2 B2Vec2) B2Mat22 + func MakeB2Mat22FromScalars(a11, a12, a21, a22 float64) B2Mat22 + func NewB2Mat22() *B2Mat22 + func NewB2Mat22FromColumns(c1, c2 B2Vec2) *B2Mat22 + func NewB2Mat22FromScalars(a11, a12, a21, a22 float64) *B2Mat22 + func (m *B2Mat22) Set(c1 B2Vec2, c2 B2Vec2) + func (m *B2Mat22) SetIdentity() + func (m *B2Mat22) SetZero() + func (m B2Mat22) GetInverse() B2Mat22 + func (m B2Mat22) Solve(b B2Vec2) B2Vec2 + type B2Mat33 struct + Ex B2Vec3 + Ey B2Vec3 + Ez B2Vec3 + func MakeB2Mat33() B2Mat33 + func MakeB2Mat33FromColumns(c1, c2, c3 B2Vec3) B2Mat33 + func NewB2Mat33() *B2Mat33 + func NewB2Mat33FromColumns(c1, c2, c3 B2Vec3) *B2Mat33 + func (m *B2Mat33) SetZero() + func (mat B2Mat33) GetInverse22(M *B2Mat33) + func (mat B2Mat33) GetSymInverse33(M *B2Mat33) + func (mat B2Mat33) Solve22(b B2Vec2) B2Vec2 + func (mat B2Mat33) Solve33(b B2Vec3) B2Vec3 + type B2MotorJoint struct + M_angularError float64 + M_angularImpulse float64 + M_angularMass float64 + M_angularOffset float64 + M_correctionFactor float64 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_linearError B2Vec2 + M_linearImpulse B2Vec2 + M_linearMass B2Mat22 + M_linearOffset B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_maxForce float64 + M_maxTorque float64 + M_rA B2Vec2 + M_rB B2Vec2 + func MakeB2MotorJoint(def *B2MotorJointDef) *B2MotorJoint + func (joint *B2MotorJoint) Dump() + func (joint *B2MotorJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2MotorJoint) SetAngularOffset(angularOffset float64) + func (joint *B2MotorJoint) SetCorrectionFactor(factor float64) + func (joint *B2MotorJoint) SetLinearOffset(linearOffset B2Vec2) + func (joint *B2MotorJoint) SetMaxForce(force float64) + func (joint *B2MotorJoint) SetMaxTorque(torque float64) + func (joint *B2MotorJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2MotorJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2MotorJoint) GetAnchorA() B2Vec2 + func (joint B2MotorJoint) GetAnchorB() B2Vec2 + func (joint B2MotorJoint) GetAngularOffset() float64 + func (joint B2MotorJoint) GetCorrectionFactor() float64 + func (joint B2MotorJoint) GetLinearOffset() B2Vec2 + func (joint B2MotorJoint) GetMaxForce() float64 + func (joint B2MotorJoint) GetMaxTorque() float64 + func (joint B2MotorJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2MotorJoint) GetReactionTorque(inv_dt float64) float64 + type B2MotorJointDef struct + AngularOffset float64 + CorrectionFactor float64 + LinearOffset B2Vec2 + MaxForce float64 + MaxTorque float64 + func MakeB2MotorJointDef() B2MotorJointDef + func (def *B2MotorJointDef) Initialize(bA *B2Body, bB *B2Body) + type B2MouseJoint struct + M_C B2Vec2 + M_beta float64 + M_dampingRatio float64 + M_frequencyHz float64 + M_gamma float64 + M_impulse B2Vec2 + M_indexA int + M_indexB int + M_invIB float64 + M_invMassB float64 + M_localAnchorB B2Vec2 + M_localCenterB B2Vec2 + M_mass B2Mat22 + M_maxForce float64 + M_rB B2Vec2 + M_targetA B2Vec2 + func MakeB2MouseJoint(def *B2MouseJointDef) *B2MouseJoint + func (def *B2MouseJoint) Dump() + func (joint *B2MouseJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2MouseJoint) SetDampingRatio(ratio float64) + func (joint *B2MouseJoint) SetFrequency(hz float64) + func (joint *B2MouseJoint) SetMaxForce(force float64) + func (joint *B2MouseJoint) SetTarget(target B2Vec2) + func (joint *B2MouseJoint) ShiftOrigin(newOrigin B2Vec2) + func (joint *B2MouseJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2MouseJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2MouseJoint) GetAnchorA() B2Vec2 + func (joint B2MouseJoint) GetAnchorB() B2Vec2 + func (joint B2MouseJoint) GetDampingRatio() float64 + func (joint B2MouseJoint) GetFrequency() float64 + func (joint B2MouseJoint) GetMaxForce() float64 + func (joint B2MouseJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2MouseJoint) GetReactionTorque(inv_dt float64) float64 + func (joint B2MouseJoint) GetTarget() B2Vec2 + type B2MouseJointDef struct + DampingRatio float64 + FrequencyHz float64 + MaxForce float64 + Target B2Vec2 + func MakeB2MouseJointDef() B2MouseJointDef + type B2Pair struct + ProxyIdA int + ProxyIdB int + type B2PolygonAndCircleContact struct + func (contact *B2PolygonAndCircleContact) Evaluate(manifold *B2Manifold, xfA B2Transform, xfB B2Transform) + type B2PolygonContact struct + func (contact *B2PolygonContact) Evaluate(manifold *B2Manifold, xfA B2Transform, xfB B2Transform) + type B2PolygonShape struct + M_centroid B2Vec2 + M_count int + M_normals [B2_maxPolygonVertices]B2Vec2 + M_vertices [B2_maxPolygonVertices]B2Vec2 + func MakeB2PolygonShape() B2PolygonShape + func NewB2PolygonShape() *B2PolygonShape + func (edge *B2PolygonShape) Destroy() + func (poly *B2PolygonShape) Set(vertices []B2Vec2, count int) + func (poly *B2PolygonShape) SetAsBox(hx float64, hy float64) + func (poly *B2PolygonShape) SetAsBoxFromCenterAndAngle(hx float64, hy float64, center B2Vec2, angle float64) + func (poly B2PolygonShape) Clone() B2ShapeInterface + func (poly B2PolygonShape) ComputeAABB(aabb *B2AABB, xf B2Transform, childIndex int) + func (poly B2PolygonShape) ComputeMass(massData *B2MassData, density float64) + func (poly B2PolygonShape) GetChildCount() int + func (poly B2PolygonShape) RayCast(output *B2RayCastOutput, input B2RayCastInput, xf B2Transform, childIndex int) bool + func (poly B2PolygonShape) TestPoint(xf B2Transform, p B2Vec2) bool + func (poly B2PolygonShape) Validate() bool + type B2Position struct + A float64 + C B2Vec2 + type B2PositionSolverManifold struct + Normal B2Vec2 + Point B2Vec2 + Separation float64 + func MakeB2PositionSolverManifold() B2PositionSolverManifold + func (solvermanifold *B2PositionSolverManifold) Initialize(pc *B2ContactPositionConstraint, xfA B2Transform, xfB B2Transform, index int) + type B2PrismaticJoint struct + M_K B2Mat33 + M_a1 float64 + M_a2 float64 + M_axis B2Vec2 + M_enableLimit bool + M_enableMotor bool + M_impulse B2Vec3 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_limitState uint8 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_localXAxisA B2Vec2 + M_localYAxisA B2Vec2 + M_lowerTranslation float64 + M_maxMotorForce float64 + M_motorImpulse float64 + M_motorMass float64 + M_motorSpeed float64 + M_perp B2Vec2 + M_referenceAngle float64 + M_s1 float64 + M_s2 float64 + M_upperTranslation float64 + func MakeB2PrismaticJoint(def *B2PrismaticJointDef) *B2PrismaticJoint + func (joint *B2PrismaticJoint) Dump() + func (joint *B2PrismaticJoint) EnableLimit(flag bool) + func (joint *B2PrismaticJoint) EnableMotor(flag bool) + func (joint *B2PrismaticJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2PrismaticJoint) SetLimits(lower float64, upper float64) + func (joint *B2PrismaticJoint) SetMaxMotorForce(force float64) + func (joint *B2PrismaticJoint) SetMotorSpeed(speed float64) + func (joint *B2PrismaticJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2PrismaticJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2PrismaticJoint) GetAnchorA() B2Vec2 + func (joint B2PrismaticJoint) GetAnchorB() B2Vec2 + func (joint B2PrismaticJoint) GetJointSpeed() float64 + func (joint B2PrismaticJoint) GetJointTranslation() float64 + func (joint B2PrismaticJoint) GetLocalAnchorA() B2Vec2 + func (joint B2PrismaticJoint) GetLocalAnchorB() B2Vec2 + func (joint B2PrismaticJoint) GetLocalAxisA() B2Vec2 + func (joint B2PrismaticJoint) GetLowerLimit() float64 + func (joint B2PrismaticJoint) GetMaxMotorForce() float64 + func (joint B2PrismaticJoint) GetMotorForce(inv_dt float64) float64 + func (joint B2PrismaticJoint) GetMotorSpeed() float64 + func (joint B2PrismaticJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2PrismaticJoint) GetReactionTorque(inv_dt float64) float64 + func (joint B2PrismaticJoint) GetReferenceAngle() float64 + func (joint B2PrismaticJoint) GetUpperLimit() float64 + func (joint B2PrismaticJoint) IsLimitEnabled() bool + func (joint B2PrismaticJoint) IsMotorEnabled() bool + type B2PrismaticJointDef struct + EnableLimit bool + EnableMotor bool + LocalAnchorA B2Vec2 + LocalAnchorB B2Vec2 + LocalAxisA B2Vec2 + LowerTranslation float64 + MaxMotorForce float64 + MotorSpeed float64 + ReferenceAngle float64 + UpperTranslation float64 + func MakeB2PrismaticJointDef() B2PrismaticJointDef + func (joint *B2PrismaticJointDef) Initialize(bA *B2Body, bB *B2Body, anchor B2Vec2, axis B2Vec2) + type B2Profile struct + Broadphase float64 + Collide float64 + Solve float64 + SolveInit float64 + SolvePosition float64 + SolveTOI float64 + SolveVelocity float64 + Step float64 + func MakeB2Profile() B2Profile + type B2PulleyJoint struct + M_constant float64 + M_groundAnchorA B2Vec2 + M_groundAnchorB B2Vec2 + M_impulse float64 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_lengthA float64 + M_lengthB float64 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_mass float64 + M_rA B2Vec2 + M_rB B2Vec2 + M_ratio float64 + M_uA B2Vec2 + M_uB B2Vec2 + func MakeB2PulleyJoint(def *B2PulleyJointDef) *B2PulleyJoint + func (joint *B2PulleyJoint) Dump() + func (joint *B2PulleyJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2PulleyJoint) ShiftOrigin(newOrigin B2Vec2) + func (joint *B2PulleyJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2PulleyJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2PulleyJoint) GetAnchorA() B2Vec2 + func (joint B2PulleyJoint) GetAnchorB() B2Vec2 + func (joint B2PulleyJoint) GetCurrentLengthA() float64 + func (joint B2PulleyJoint) GetCurrentLengthB() float64 + func (joint B2PulleyJoint) GetGroundAnchorA() B2Vec2 + func (joint B2PulleyJoint) GetGroundAnchorB() B2Vec2 + func (joint B2PulleyJoint) GetLengthA() float64 + func (joint B2PulleyJoint) GetLengthB() float64 + func (joint B2PulleyJoint) GetRatio() float64 + func (joint B2PulleyJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2PulleyJoint) GetReactionTorque(inv_dt float64) float64 + type B2PulleyJointDef struct + GroundAnchorA B2Vec2 + GroundAnchorB B2Vec2 + LengthA float64 + LengthB float64 + LocalAnchorA B2Vec2 + LocalAnchorB B2Vec2 + Ratio float64 + func MakeB2PulleyJointDef() B2PulleyJointDef + func (def *B2PulleyJointDef) Initialize(bA *B2Body, bB *B2Body, groundA B2Vec2, groundB B2Vec2, anchorA B2Vec2, ...) + type B2RayCastInput struct + MaxFraction float64 + P1 B2Vec2 + P2 B2Vec2 + func MakeB2RayCastInput() B2RayCastInput + func NewB2RayCastInput() *B2RayCastInput + type B2RayCastOutput struct + Fraction float64 + Normal B2Vec2 + func MakeB2RayCastOutput() B2RayCastOutput + type B2RaycastCallback func(fixture *B2Fixture, point B2Vec2, normal B2Vec2, fraction float64) float64 + type B2ReferenceFace struct + I1 int + I2 int + Normal B2Vec2 + SideNormal1 B2Vec2 + SideNormal2 B2Vec2 + SideOffset1 float64 + SideOffset2 float64 + V1 B2Vec2 + V2 B2Vec2 + func MakeB2ReferenceFace() B2ReferenceFace + type B2RevoluteJoint struct + M_enableLimit bool + M_enableMotor bool + M_impulse B2Vec3 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_limitState uint8 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_lowerAngle float64 + M_mass B2Mat33 + M_maxMotorTorque float64 + M_motorImpulse float64 + M_motorMass float64 + M_motorSpeed float64 + M_rA B2Vec2 + M_rB B2Vec2 + M_referenceAngle float64 + M_upperAngle float64 + func MakeB2RevoluteJoint(def *B2RevoluteJointDef) *B2RevoluteJoint + func (joint *B2RevoluteJoint) Dump() + func (joint *B2RevoluteJoint) EnableLimit(flag bool) + func (joint *B2RevoluteJoint) EnableMotor(flag bool) + func (joint *B2RevoluteJoint) GetJointSpeed() float64 + func (joint *B2RevoluteJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2RevoluteJoint) SetLimits(lower float64, upper float64) + func (joint *B2RevoluteJoint) SetMaxMotorTorque(torque float64) + func (joint *B2RevoluteJoint) SetMotorSpeed(speed float64) + func (joint *B2RevoluteJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2RevoluteJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2RevoluteJoint) GetAnchorA() B2Vec2 + func (joint B2RevoluteJoint) GetAnchorB() B2Vec2 + func (joint B2RevoluteJoint) GetJointAngle() float64 + func (joint B2RevoluteJoint) GetLocalAnchorA() B2Vec2 + func (joint B2RevoluteJoint) GetLocalAnchorB() B2Vec2 + func (joint B2RevoluteJoint) GetLowerLimit() float64 + func (joint B2RevoluteJoint) GetMaxMotorTorque() float64 + func (joint B2RevoluteJoint) GetMotorSpeed() float64 + func (joint B2RevoluteJoint) GetMotorTorque(inv_dt float64) float64 + func (joint B2RevoluteJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2RevoluteJoint) GetReactionTorque(inv_dt float64) float64 + func (joint B2RevoluteJoint) GetReferenceAngle() float64 + func (joint B2RevoluteJoint) GetUpperLimit() float64 + func (joint B2RevoluteJoint) IsLimitEnabled() bool + func (joint B2RevoluteJoint) IsMotorEnabled() bool + type B2RevoluteJointDef struct + EnableLimit bool + EnableMotor bool + LocalAnchorA B2Vec2 + LocalAnchorB B2Vec2 + LowerAngle float64 + MaxMotorTorque float64 + MotorSpeed float64 + ReferenceAngle float64 + UpperAngle float64 + func MakeB2RevoluteJointDef() B2RevoluteJointDef + func (def *B2RevoluteJointDef) Initialize(bA *B2Body, bB *B2Body, anchor B2Vec2) + type B2Rope struct + M_Ls []float64 + M_as []float64 + M_count int + M_damping float64 + M_gravity B2Vec2 + M_ims []float64 + M_k2 float64 + M_k3 float64 + M_p0s []B2Vec2 + M_ps []B2Vec2 + M_vs []B2Vec2 + func MakeB2Rope() B2Rope + func (rope *B2Rope) Destroy() + func (rope *B2Rope) Initialize(def *B2RopeDef) + func (rope *B2Rope) SetAngle(angle float64) + func (rope *B2Rope) SolveC2() + func (rope *B2Rope) SolveC3() + func (rope *B2Rope) Step(h float64, iterations int) + func (rope B2Rope) GetVertexCount() int + func (rope B2Rope) GetVertices() []B2Vec2 + type B2RopeDef struct + Count int + Damping float64 + Gravity B2Vec2 + K2 float64 + K3 float64 + Masses []float64 + Vertices []B2Vec2 + func MakeB2RopeDef() B2RopeDef + type B2RopeJoint struct + M_impulse float64 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_length float64 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_mass float64 + M_maxLength float64 + M_rA B2Vec2 + M_rB B2Vec2 + M_state uint8 + M_u B2Vec2 + func MakeB2RopeJoint(def *B2RopeJointDef) *B2RopeJoint + func (joint *B2RopeJoint) Dump() + func (joint *B2RopeJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2RopeJoint) SetMaxLength(length float64) + func (joint *B2RopeJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2RopeJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2RopeJoint) GetAnchorA() B2Vec2 + func (joint B2RopeJoint) GetAnchorB() B2Vec2 + func (joint B2RopeJoint) GetLimitState() uint8 + func (joint B2RopeJoint) GetLocalAnchorA() B2Vec2 + func (joint B2RopeJoint) GetLocalAnchorB() B2Vec2 + func (joint B2RopeJoint) GetMaxLength() float64 + func (joint B2RopeJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2RopeJoint) GetReactionTorque(inv_dt float64) float64 + type B2RopeJointDef struct + LocalAnchorA B2Vec2 + LocalAnchorB B2Vec2 + MaxLength float64 + func MakeB2RopeJointDef() B2RopeJointDef + type B2Rot struct + C float64 + S float64 + func B2RotMul(q, r B2Rot) B2Rot + func B2RotMulT(q, r B2Rot) B2Rot + func MakeB2Rot() B2Rot + func MakeB2RotFromAngle(anglerad float64) B2Rot + func NewB2Rot() *B2Rot + func NewB2RotFromAngle(anglerad float64) *B2Rot + func (r *B2Rot) Set(anglerad float64) + func (r *B2Rot) SetIdentity() + func (r B2Rot) GetAngle() float64 + func (r B2Rot) GetXAxis() B2Vec2 + func (r B2Rot) GetYAxis() B2Vec2 + type B2SeparationFunction struct + M_axis B2Vec2 + M_localPoint B2Vec2 + M_proxyA *B2DistanceProxy + M_proxyB *B2DistanceProxy + M_sweepA B2Sweep + M_sweepB B2Sweep + M_type uint8 + func (sepfunc *B2SeparationFunction) Evaluate(indexA int, indexB int, t float64) float64 + func (sepfunc *B2SeparationFunction) FindMinSeparation(indexA *int, indexB *int, t float64) float64 + func (sepfunc *B2SeparationFunction) Initialize(cache *B2SimplexCache, proxyA *B2DistanceProxy, sweepA B2Sweep, ...) float64 + type B2Shape struct + M_radius float64 + M_type uint8 + func (shape *B2Shape) SetRadius(r float64) + func (shape B2Shape) GetRadius() float64 + func (shape B2Shape) GetType() uint8 + type B2ShapeInterface interface + Clone func() B2ShapeInterface + ComputeAABB func(aabb *B2AABB, xf B2Transform, childIndex int) + ComputeMass func(massData *B2MassData, density float64) + Destroy func() + GetChildCount func() int + GetRadius func() float64 + GetType func() uint8 + RayCast func(output *B2RayCastOutput, input B2RayCastInput, transform B2Transform, ...) bool + TestPoint func(xf B2Transform, p B2Vec2) bool + type B2Simplex struct + M_count int + M_vs [3]B2SimplexVertex + func MakeB2Simplex() B2Simplex + func NewB2Simplex() *B2Simplex + func (simplex *B2Simplex) ReadCache(cache *B2SimplexCache, proxyA *B2DistanceProxy, transformA B2Transform, ...) + func (simplex *B2Simplex) Solve2() + func (simplex *B2Simplex) Solve3() + func (simplex B2Simplex) GetClosestPoint() B2Vec2 + func (simplex B2Simplex) GetMetric() float64 + func (simplex B2Simplex) GetSearchDirection() B2Vec2 + func (simplex B2Simplex) GetWitnessPoints(pA *B2Vec2, pB *B2Vec2) + func (simplex B2Simplex) WriteCache(cache *B2SimplexCache) + type B2SimplexCache struct + Count int + IndexA [3]int + IndexB [3]int + Metric float64 + func MakeB2SimplexCache() B2SimplexCache + func NewB2SimplexCache() *B2SimplexCache + type B2SimplexVertex struct + A float64 + IndexA int + IndexB int + W B2Vec2 + WA B2Vec2 + WB B2Vec2 + func MakeB2SimplexVertex() B2SimplexVertex + func NewB2SimplexVertex() *B2SimplexVertex + type B2SolverData struct + Positions []B2Position + Step B2TimeStep + Velocities []B2Velocity + func MakeB2SolverData() B2SolverData + type B2Sweep struct + A float64 + A0 float64 + Alpha0 float64 + C B2Vec2 + C0 B2Vec2 + LocalCenter B2Vec2 + func (sweep *B2Sweep) Advance(alpha float64) + func (sweep *B2Sweep) Normalize() + func (sweep B2Sweep) GetTransform(xf *B2Transform, beta float64) + type B2TOIInput struct + ProxyA B2DistanceProxy + ProxyB B2DistanceProxy + SweepA B2Sweep + SweepB B2Sweep + TMax float64 + func MakeB2TOIInput() B2TOIInput + type B2TOIOutput struct + State uint8 + T float64 + func MakeB2TOIOutput() B2TOIOutput + type B2TempPolygon struct + Count int + Normals [B2_maxPolygonVertices]B2Vec2 + Vertices [B2_maxPolygonVertices]B2Vec2 + type B2TimeStep struct + Dt float64 + DtRatio float64 + Inv_dt float64 + PositionIterations int + VelocityIterations int + WarmStarting bool + func MakeB2TimeStep() B2TimeStep + type B2Timer struct + func MakeB2Timer() B2Timer + func (timer *B2Timer) Reset() + func (timer B2Timer) GetMilliseconds() float64 + type B2Transform struct + P B2Vec2 + Q B2Rot + func B2TransformMul(A, B B2Transform) B2Transform + func B2TransformMulT(A, B B2Transform) B2Transform + func MakeB2Transform() B2Transform + func MakeB2TransformByPositionAndRotation(position B2Vec2, rotation B2Rot) B2Transform + func NewB2Transform() *B2Transform + func NewB2TransformByPositionAndRotation(position B2Vec2, rotation B2Rot) *B2Transform + func (t *B2Transform) Set(position B2Vec2, anglerad float64) + func (t *B2Transform) SetIdentity() + type B2TreeNode struct + Aabb B2AABB + Child1 int + Child2 int + Height int + Next int + Parent int + UserData interface{} + func (node B2TreeNode) IsLeaf() bool + type B2TreeQueryCallback func(nodeId int) bool + type B2TreeRayCastCallback func(input B2RayCastInput, nodeId int) float64 + type B2Vec2 struct + X float64 + Y float64 + func B2RotVec2Mul(q B2Rot, v B2Vec2) B2Vec2 + func B2RotVec2MulT(q B2Rot, v B2Vec2) B2Vec2 + func B2TransformVec2Mul(T B2Transform, v B2Vec2) B2Vec2 + func B2TransformVec2MulT(T B2Transform, v B2Vec2) B2Vec2 + func B2Vec2Abs(a B2Vec2) B2Vec2 + func B2Vec2Add(a, b B2Vec2) B2Vec2 + func B2Vec2Clamp(a, low, high B2Vec2) B2Vec2 + func B2Vec2CrossScalarVector(s float64, a B2Vec2) B2Vec2 + func B2Vec2CrossVectorScalar(a B2Vec2, s float64) B2Vec2 + func B2Vec2Mat22Mul(A B2Mat22, v B2Vec2) B2Vec2 + func B2Vec2Mat22MulT(A B2Mat22, v B2Vec2) B2Vec2 + func B2Vec2Max(a, b B2Vec2) B2Vec2 + func B2Vec2Min(a, b B2Vec2) B2Vec2 + func B2Vec2Mul22(A B2Mat33, v B2Vec2) B2Vec2 + func B2Vec2MulScalar(s float64, a B2Vec2) B2Vec2 + func B2Vec2Sub(a, b B2Vec2) B2Vec2 + func ComputeCentroid(vs []B2Vec2, count int) B2Vec2 + func MakeB2Vec2(xIn, yIn float64) B2Vec2 + func NewB2Vec2(xIn, yIn float64) *B2Vec2 + func (v *B2Vec2) Normalize() float64 + func (v *B2Vec2) OperatorIndexSet(i int, value float64) + func (v *B2Vec2) OperatorMinusInplace(other B2Vec2) + func (v *B2Vec2) OperatorPlusInplace(other B2Vec2) + func (v *B2Vec2) OperatorScalarMulInplace(a float64) + func (v *B2Vec2) Set(x, y float64) + func (v *B2Vec2) SetZero() + func (v B2Vec2) Clone() B2Vec2 + func (v B2Vec2) IsValid() bool + func (v B2Vec2) Length() float64 + func (v B2Vec2) LengthSquared() float64 + func (v B2Vec2) OperatorIndexGet(i int) float64 + func (v B2Vec2) OperatorNegate() B2Vec2 + func (v B2Vec2) Skew() B2Vec2 + type B2Vec3 struct + X float64 + Y float64 + Z float64 + func B2Vec3Add(a, b B2Vec3) B2Vec3 + func B2Vec3Cross(a, b B2Vec3) B2Vec3 + func B2Vec3Mat33Mul(A B2Mat33, v B2Vec3) B2Vec3 + func B2Vec3MultScalar(s float64, a B2Vec3) B2Vec3 + func B2Vec3Sub(a, b B2Vec3) B2Vec3 + func MakeB2Vec3(xIn, yIn, zIn float64) B2Vec3 + func NewB2Vec3(xIn, yIn, zIn float64) *B2Vec3 + func (v *B2Vec3) OperatorMinusInplace(other B2Vec3) + func (v *B2Vec3) OperatorPlusInplace(other B2Vec3) + func (v *B2Vec3) OperatorScalarMultInplace(a float64) + func (v *B2Vec3) Set(x, y, z float64) + func (v *B2Vec3) SetZero() + func (v B2Vec3) OperatorNegate() B2Vec3 + type B2Velocity struct + V B2Vec2 + W float64 + type B2VelocityConstraintPoint struct + NormalImpulse float64 + NormalMass float64 + RA B2Vec2 + RB B2Vec2 + TangentImpulse float64 + TangentMass float64 + VelocityBias float64 + type B2WeldJoint struct + M_bias float64 + M_dampingRatio float64 + M_frequencyHz float64 + M_gamma float64 + M_impulse B2Vec3 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_mass B2Mat33 + M_rA B2Vec2 + M_rB B2Vec2 + M_referenceAngle float64 + func MakeB2WeldJoint(def *B2WeldJointDef) *B2WeldJoint + func (joint *B2WeldJoint) Dump() + func (joint *B2WeldJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2WeldJoint) SetDampingRatio(ratio float64) + func (joint *B2WeldJoint) SetFrequency(hz float64) + func (joint *B2WeldJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2WeldJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2WeldJoint) GetAnchorA() B2Vec2 + func (joint B2WeldJoint) GetAnchorB() B2Vec2 + func (joint B2WeldJoint) GetDampingRatio() float64 + func (joint B2WeldJoint) GetFrequency() float64 + func (joint B2WeldJoint) GetLocalAnchorA() B2Vec2 + func (joint B2WeldJoint) GetLocalAnchorB() B2Vec2 + func (joint B2WeldJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2WeldJoint) GetReactionTorque(inv_dt float64) float64 + func (joint B2WeldJoint) GetReferenceAngle() float64 + type B2WeldJointDef struct + DampingRatio float64 + FrequencyHz float64 + LocalAnchorA B2Vec2 + LocalAnchorB B2Vec2 + ReferenceAngle float64 + func MakeB2WeldJointDef() B2WeldJointDef + func (def *B2WeldJointDef) Initialize(bA *B2Body, bB *B2Body, anchor B2Vec2) + type B2WheelJoint struct + M_ax B2Vec2 + M_ay B2Vec2 + M_bias float64 + M_dampingRatio float64 + M_enableMotor bool + M_frequencyHz float64 + M_gamma float64 + M_impulse float64 + M_indexA int + M_indexB int + M_invIA float64 + M_invIB float64 + M_invMassA float64 + M_invMassB float64 + M_localAnchorA B2Vec2 + M_localAnchorB B2Vec2 + M_localCenterA B2Vec2 + M_localCenterB B2Vec2 + M_localXAxisA B2Vec2 + M_localYAxisA B2Vec2 + M_mass float64 + M_maxMotorTorque float64 + M_motorImpulse float64 + M_motorMass float64 + M_motorSpeed float64 + M_sAx float64 + M_sAy float64 + M_sBx float64 + M_sBy float64 + M_springImpulse float64 + M_springMass float64 + func MakeB2WheelJoint(def *B2WheelJointDef) *B2WheelJoint + func (joint *B2WheelJoint) Dump() + func (joint *B2WheelJoint) EnableMotor(flag bool) + func (joint *B2WheelJoint) InitVelocityConstraints(data B2SolverData) + func (joint *B2WheelJoint) SetMaxMotorTorque(torque float64) + func (joint *B2WheelJoint) SetMotorSpeed(speed float64) + func (joint *B2WheelJoint) SetSpringDampingRatio(ratio float64) + func (joint *B2WheelJoint) SetSpringFrequencyHz(hz float64) + func (joint *B2WheelJoint) SolvePositionConstraints(data B2SolverData) bool + func (joint *B2WheelJoint) SolveVelocityConstraints(data B2SolverData) + func (joint B2WheelJoint) GetAnchorA() B2Vec2 + func (joint B2WheelJoint) GetAnchorB() B2Vec2 + func (joint B2WheelJoint) GetJointAngle() float64 + func (joint B2WheelJoint) GetJointAngularSpeed() float64 + func (joint B2WheelJoint) GetJointLinearSpeed() float64 + func (joint B2WheelJoint) GetJointTranslation() float64 + func (joint B2WheelJoint) GetLocalAnchorA() B2Vec2 + func (joint B2WheelJoint) GetLocalAnchorB() B2Vec2 + func (joint B2WheelJoint) GetLocalAxisA() B2Vec2 + func (joint B2WheelJoint) GetMaxMotorTorque() float64 + func (joint B2WheelJoint) GetMotorSpeed() float64 + func (joint B2WheelJoint) GetMotorTorque(inv_dt float64) float64 + func (joint B2WheelJoint) GetReactionForce(inv_dt float64) B2Vec2 + func (joint B2WheelJoint) GetReactionTorque(inv_dt float64) float64 + func (joint B2WheelJoint) GetSpringDampingRatio() float64 + func (joint B2WheelJoint) GetSpringFrequencyHz() float64 + func (joint B2WheelJoint) IsMotorEnabled() bool + type B2WheelJointDef struct + DampingRatio float64 + EnableMotor bool + FrequencyHz float64 + LocalAnchorA B2Vec2 + LocalAnchorB B2Vec2 + LocalAxisA B2Vec2 + MaxMotorTorque float64 + MotorSpeed float64 + func MakeB2WheelJointDef() B2WheelJointDef + func (def *B2WheelJointDef) Initialize(bA *B2Body, bB *B2Body, anchor B2Vec2, axis B2Vec2) + type B2World struct + M_allowSleep bool + M_bodyCount int + M_bodyList *B2Body + M_contactManager B2ContactManager + M_continuousPhysics bool + M_destructionListener B2DestructionListenerInterface + M_flags int + M_gravity B2Vec2 + M_inv_dt0 float64 + M_jointCount int + M_jointList B2JointInterface + M_profile B2Profile + M_stepComplete bool + M_subStepping bool + M_warmStarting bool + func MakeB2World(gravity B2Vec2) B2World + func (world *B2World) ClearForces() + func (world *B2World) CreateBody(def *B2BodyDef) *B2Body + func (world *B2World) CreateJoint(def *B2JointDef) B2JointInterface + func (world *B2World) Destroy() + func (world *B2World) DestroyBody(b *B2Body) + func (world *B2World) DestroyJoint(j B2JointInterface) + func (world *B2World) Dump() + func (world *B2World) QueryAABB(callback B2BroadPhaseQueryCallback, aabb B2AABB) + func (world *B2World) RayCast(callback B2RaycastCallback, point1 B2Vec2, point2 B2Vec2) + func (world *B2World) SetAllowSleeping(flag bool) + func (world *B2World) SetAutoClearForces(flag bool) + func (world *B2World) SetContactFilter(filter B2ContactFilterInterface) + func (world *B2World) SetContactListener(listener B2ContactListenerInterface) + func (world *B2World) SetDestructionListener(listener B2DestructionListenerInterface) + func (world *B2World) SetGravity(gravity B2Vec2) + func (world *B2World) ShiftOrigin(newOrigin B2Vec2) + func (world *B2World) Solve(step B2TimeStep) + func (world *B2World) SolveTOI(step B2TimeStep) + func (world *B2World) Step(dt float64, velocityIterations int, positionIterations int) + func (world B2World) GetAutoClearForces() bool + func (world B2World) GetBodyCount() int + func (world B2World) GetBodyList() *B2Body + func (world B2World) GetContactCount() int + func (world B2World) GetContactList() B2ContactInterface + func (world B2World) GetContactManager() B2ContactManager + func (world B2World) GetGravity() B2Vec2 + func (world B2World) GetJointCount() int + func (world B2World) GetJointList() B2JointInterface + func (world B2World) GetProfile() B2Profile + func (world B2World) GetProxyCount() int + func (world B2World) GetTreeBalance() int + func (world B2World) GetTreeHeight() int + func (world B2World) GetTreeQuality() float64 + func (world B2World) IsLocked() bool + type B2WorldManifold struct + Normal B2Vec2 + Points [B2_maxManifoldPoints]B2Vec2 + Separations [B2_maxManifoldPoints]float64 + func MakeB2WorldManifold() B2WorldManifold + func (wm *B2WorldManifold) Initialize(manifold *B2Manifold, xfA B2Transform, radiusA float64, xfB B2Transform, ...) + type B2WorldQueryWrapper struct + BroadPhase *B2BroadPhase + Callback B2BroadPhaseQueryCallback + func MakeB2WorldQueryWrapper() B2WorldQueryWrapper + func (query *B2WorldQueryWrapper) QueryCallback(proxyId int) bool + type PairByLessThan []B2Pair + func (a PairByLessThan) Len() int + func (a PairByLessThan) Less(i, j int) bool + func (a PairByLessThan) Swap(i, j int) + type StackElement struct