Yuka.js开发手册
3D场景编辑器
AABB
AABB.max
AABB.min
AABB.applyMatrix4
AABB.clampPoint
AABB.clone
AABB.containsPoint
AABB.copy
AABB.equals
AABB.expand
AABB.fromCenterAndSize
AABB.fromJSON
AABB.fromPoints
AABB.getCenter
AABB.getNormalFromSurfacePoint
AABB.getSize
AABB.intersectsAABB
AABB.intersectsBoundingSphere
AABB.intersectsPlane
AABB.set
AABB.toJSON
AlignmentBehavior
AlignmentBehavior.active
AlignmentBehavior.weight
AlignmentBehavior.calculate
AlignmentBehavior.fromJSON
AlignmentBehavior.resolveReferences
AlignmentBehavior.toJSON
ArriveBehavior
ArriveBehavior.active
ArriveBehavior.deceleration
ArriveBehavior.target
ArriveBehavior.tolerance
ArriveBehavior.weight
ArriveBehavior.calculate
ArriveBehavior.fromJSON
ArriveBehavior.resolveReferences
ArriveBehavior.toJSON
AStar
AStar.found
AStar.graph
AStar.heuristic
AStar.source
AStar.target
AStar.clear
AStar.getPath
AStar.getSearchTree
AStar.search
BFS
BFS.found
BFS.graph
BFS.source
BFS.target
BFS.clear
BFS.getPath
BFS.getSearchTree
BFS.search
BoundingSphere
BoundingSphere.center
BoundingSphere.radius
BoundingSphere.applyMatrix4
BoundingSphere.clampPoint
BoundingSphere.clone
BoundingSphere.containsPoint
BoundingSphere.copy
BoundingSphere.equals
BoundingSphere.fromJSON
BoundingSphere.fromPoints
BoundingSphere.getNormalFromSurfacePoint
BoundingSphere.intersectsBoundingSphere
BoundingSphere.intersectsPlane
BoundingSphere.set
BoundingSphere.toJSON
BVH
BVH.branchingFactor
BVH.depth
BVH.primitivesPerNode
BVH.root
BVH.fromMeshGeometry
BVH.traverse
BVHNode
BVHNode.boundingVolume
BVHNode.centroids
BVHNode.children
BVHNode.parent
BVHNode.primitives
BVHNode.build
BVHNode.computeBoundingVolume
BVHNode.computeSplitAxis
BVHNode.getDepth
BVHNode.intersectRay
BVHNode.intersectsRay
BVHNode.leaf
BVHNode.root
BVHNode.split
BVHNode.traverse
Cell
Cell.aabb
Cell.entries
Cell.add
Cell.empty
Cell.fromJSON
Cell.intersects
Cell.makeEmpty
Cell.remove
Cell.resolveReferences
Cell.toJSON
CellSpacePartitioning
CellSpacePartitioning.cells
CellSpacePartitioning.cellsX
CellSpacePartitioning.cellsY
CellSpacePartitioning.cellsZ
CellSpacePartitioning.depth
CellSpacePartitioning.height
CellSpacePartitioning.width
CellSpacePartitioning.addEntityToPartition
CellSpacePartitioning.addPolygon
CellSpacePartitioning.fromJSON
CellSpacePartitioning.getIndexForPosition
CellSpacePartitioning.makeEmpty
CellSpacePartitioning.query
CellSpacePartitioning.removeEntityFromPartition
CellSpacePartitioning.resolveReferences
CellSpacePartitioning.toJSON
CellSpacePartitioning.updateEntity
CohesionBehavior
CohesionBehavior.active
CohesionBehavior.weight
CohesionBehavior.calculate
CohesionBehavior.fromJSON
CohesionBehavior.resolveReferences
CohesionBehavior.toJSON
CompositeGoal
CompositeGoal.owner
CompositeGoal.status
CompositeGoal.subgoals
CompositeGoal.activate
CompositeGoal.activateIfInactive
CompositeGoal.active
CompositeGoal.addSubgoal
CompositeGoal.clearSubgoals
CompositeGoal.completed
CompositeGoal.currentSubgoal
CompositeGoal.execute
CompositeGoal.executeSubgoals
CompositeGoal.failed
CompositeGoal.fromJSON
CompositeGoal.handleMessage
CompositeGoal.hasSubgoals
CompositeGoal.inactive
CompositeGoal.removeSubgoal
CompositeGoal.replanIfFailed
CompositeGoal.resolveReferences
CompositeGoal.terminate
CompositeGoal.toJSON
ConvexHull
ConvexHull.centroid
ConvexHull.edges
ConvexHull.faces
ConvexHull.mergeFaces
ConvexHull.vertices
ConvexHull.computeCentroid
ConvexHull.computeUniqueEdges
ConvexHull.computeUniqueVertices
ConvexHull.containsPoint
ConvexHull.fromAABB
ConvexHull.fromPoints
ConvexHull.intersectsAABB
ConvexHull.intersectsConvexHull
Corridor
Corridor.portalEdges
Corridor.generate
Corridor.push
CostTable
CostTable.clear
CostTable.fromJSON
CostTable.get
CostTable.init
CostTable.set
CostTable.size
CostTable.toJSON
DFS
DFS.found
DFS.graph
DFS.source
DFS.target
DFS.clear
DFS.getPath
DFS.getSearchTree
DFS.search
Dijkstra
Dijkstra.found
Dijkstra.graph
Dijkstra.source
Dijkstra.target
Dijkstra.clear
Dijkstra.getPath
Dijkstra.getSearchTree
Dijkstra.search
Edge
Edge.cost
Edge.from
Edge.to
Edge.clone
Edge.copy
Edge.fromJSON
Edge.toJSON
EntityManager
EntityManager.entities
EntityManager.spatialIndex
EntityManager.add
EntityManager.clear
EntityManager.fromJSON
EntityManager.getEntityByName
EntityManager.processTrigger
EntityManager.registerType
EntityManager.remove
EntityManager.sendMessage
EntityManager.toJSON
EntityManager.update
EntityManager.updateEntity
EntityManager.updateNeighborhood
EvadeBehavior
EvadeBehavior.active
EvadeBehavior.panicDistance
EvadeBehavior.predictionFactor
EvadeBehavior.pursuer
EvadeBehavior.weight
EvadeBehavior.calculate
EvadeBehavior.fromJSON
EvadeBehavior.resolveReferences
EvadeBehavior.toJSON
EventDispatcher
EventDispatcher.addEventListener
EventDispatcher.dispatchEvent
EventDispatcher.hasEventListener
EventDispatcher.removeEventListener
Behavior
Behavior.active
Behavior.panicDistance
Behavior.target
Behavior.weight
Behavior.calculate
Behavior.fromJSON
Behavior.resolveReferences
Behavior.toJSON
FollowPathBehavior
FollowPathBehavior.active
FollowPathBehavior.nextWaypointDistance
FollowPathBehavior.path
FollowPathBehavior.weight
FollowPathBehavior.calculate
FollowPathBehavior.fromJSON
FollowPathBehavior.resolveReferences
FollowPathBehavior.toJSON
FuzzyAND
FuzzyAND.terms
FuzzyAND.clearDegreeOfMembership
FuzzyAND.getDegreeOfMembership
FuzzyAND.toJSON
FuzzyAND.updateDegreeOfMembership
FuzzyCompositeTerm
FuzzyCompositeTerm.terms
FuzzyCompositeTerm.clearDegreeOfMembership
FuzzyCompositeTerm.getDegreeOfMembership
FuzzyCompositeTerm.toJSON
FuzzyCompositeTerm.updateDegreeOfMembership
FuzzyFAIRLY
FuzzyFAIRLY.terms
FuzzyFAIRLY.clearDegreeOfMembership
FuzzyFAIRLY.getDegreeOfMembership
FuzzyFAIRLY.toJSON
FuzzyFAIRLY.updateDegreeOfMembership
FuzzyModule
FuzzyModule.flvs
FuzzyModule.rules
FuzzyModule.addFLV
FuzzyModule.addRule
FuzzyModule.defuzzify
FuzzyModule.fromJSON
FuzzyModule.fuzzify
FuzzyModule.removeFLV
FuzzyModule.removeRule
FuzzyModule.toJSON
FuzzyOR
FuzzyOR.terms
FuzzyOR.clearDegreeOfMembership
FuzzyOR.getDegreeOfMembership
FuzzyOR.toJSON
FuzzyOR.updateDegreeOfMembership
FuzzyRule
FuzzyRule.antecedent
FuzzyRule.consequence
FuzzyRule.evaluate
FuzzyRule.fromJSON
FuzzyRule.initConsequence
FuzzyRule.toJSON
FuzzySet
FuzzySet.degreeOfMembership
FuzzySet.left
FuzzySet.representativeValue
FuzzySet.right
FuzzySet.uuid
FuzzySet.clearDegreeOfMembership
FuzzySet.computeDegreeOfMembership
FuzzySet.fromJSON
FuzzySet.getDegreeOfMembership
FuzzySet.toJSON
FuzzySet.updateDegreeOfMembership
FuzzyTerm
FuzzyTerm.clearDegreeOfMembership
FuzzyTerm.getDegreeOfMembership
FuzzyTerm.toJSON
FuzzyTerm.updateDegreeOfMembership
FuzzyVariable
FuzzyVariable.fuzzySets
FuzzyVariable.maxRange
FuzzyVariable.minRange
FuzzyVariable.add
FuzzyVariable.defuzzifyCentroid
FuzzyVariable.defuzzifyMaxAv
FuzzyVariable.fromJSON
FuzzyVariable.fuzzify
FuzzyVariable.remove
FuzzyVariable.toJSON
FuzzyVERY
FuzzyVERY.terms
FuzzyVERY.clearDegreeOfMembership
FuzzyVERY.getDegreeOfMembership
FuzzyVERY.toJSON
FuzzyVERY.updateDegreeOfMembership
GameEntity
GameEntity.active
GameEntity.boundingRadius
GameEntity.canActivateTrigger
GameEntity.children
GameEntity.forward
GameEntity.manager
GameEntity.maxTurnRate
GameEntity.name
GameEntity.neighborhoodRadius
GameEntity.neighbors
GameEntity.parent
GameEntity.position
GameEntity.rotation
GameEntity.scale
GameEntity.up
GameEntity.updateNeighborhood
GameEntity.uuid
GameEntity.worldMatrix
GameEntity.add
GameEntity.fromJSON
GameEntity.getDirection
GameEntity.getWorldDirection
GameEntity.getWorldPosition
GameEntity.handleMessage
GameEntity.lineOfSightTest
GameEntity.lookAt
GameEntity.remove
GameEntity.resolveReferences
GameEntity.rotateTo
GameEntity.sendMessage
GameEntity.setRenderComponent
GameEntity.start
GameEntity.toJSON
GameEntity.update
Goal
Goal.owner
Goal.status
Goal.activate
Goal.activateIfInactive
Goal.active
Goal.completed
Goal.execute
Goal.failed
Goal.fromJSON
Goal.handleMessage
Goal.inactive
Goal.replanIfFailed
Goal.resolveReferences
Goal.terminate
Goal.toJSON
GoalEvaluator
GoalEvaluator.characterBias
GoalEvaluator.calculateDesirability
GoalEvaluator.fromJSON
GoalEvaluator.setGoal
GoalEvaluator.toJSON
Graph
Graph.digraph
Graph.addEdge
Graph.addNode
Graph.clear
Graph.fromJSON
Graph.getEdge
Graph.getEdgeCount
Graph.getEdgesOfNode
Graph.getNode
Graph.getNodeCount
Graph.getNodes
Graph.hasEdge
Graph.hasNode
Graph.removeEdge
Graph.removeNode
Graph.toJSON
GraphUtils
GraphUtils.createGridLayout
HalfEdge
HalfEdge.next
HalfEdge.polygon
HalfEdge.prev
HalfEdge.twin
HalfEdge.vertex
HalfEdge.getDirection
HalfEdge.head
HalfEdge.length
HalfEdge.linkOpponent
HalfEdge.squaredLength
HalfEdge.tail
HeuristicPolicyDijkstra
HeuristicPolicyDijkstra.calculate
HeuristicPolicyEuclid
HeuristicPolicyEuclid.calculate
HeuristicPolicyEuclidSquared
HeuristicPolicyEuclidSquared.calculate
HeuristicPolicyManhattan
HeuristicPolicyManhattan.calculate
InterposeBehavior
InterposeBehavior.active
InterposeBehavior.deceleration
InterposeBehavior.entity1
InterposeBehavior.entity2
InterposeBehavior.weight
InterposeBehavior.calculate
InterposeBehavior.fromJSON
InterposeBehavior.resolveReferences
InterposeBehavior.toJSON
LeftSCurveFuzzySet
LeftSCurveFuzzySet.degreeOfMembership
LeftSCurveFuzzySet.left
LeftSCurveFuzzySet.midpoint
LeftSCurveFuzzySet.representativeValue
LeftSCurveFuzzySet.right
LeftSCurveFuzzySet.uuid
LeftSCurveFuzzySet.clearDegreeOfMembership
LeftSCurveFuzzySet.computeDegreeOfMembership
LeftSCurveFuzzySet.fromJSON
LeftSCurveFuzzySet.getDegreeOfMembership
LeftSCurveFuzzySet.toJSON
LeftSCurveFuzzySet.updateDegreeOfMembership
LeftShoulderFuzzySet
LeftShoulderFuzzySet.degreeOfMembership
LeftShoulderFuzzySet.left
LeftShoulderFuzzySet.midpoint
LeftShoulderFuzzySet.representativeValue
LeftShoulderFuzzySet.right
LeftShoulderFuzzySet.uuid
LeftShoulderFuzzySet.clearDegreeOfMembership
LeftShoulderFuzzySet.computeDegreeOfMembership
LeftShoulderFuzzySet.fromJSON
LeftShoulderFuzzySet.getDegreeOfMembership
LeftShoulderFuzzySet.toJSON
LeftShoulderFuzzySet.updateDegreeOfMembership
LineSegment
LineSegment.from
LineSegment.to
LineSegment.at
LineSegment.clone
LineSegment.closestPointToPoint
LineSegment.closestPointToPointParameter
LineSegment.copy
LineSegment.delta
LineSegment.equals
LineSegment.set
Logger
Logger.error
Logger.log
Logger.setLevel
Logger.warn
MathUtils
MathUtils.area
MathUtils.argmax
MathUtils.choice
MathUtils.clamp
MathUtils.generateUUID
MathUtils.randFloat
MathUtils.randInt
Matrix3
Matrix3.elements
Matrix3.clone
Matrix3.copy
Matrix3.eigenDecomposition
Matrix3.equals
Matrix3.extractBasis
Matrix3.frobeniusNorm
Matrix3.fromArray
Matrix3.fromMatrix4
Matrix3.fromQuaternion
Matrix3.getElementIndex
Matrix3.identity
Matrix3.lookAt
Matrix3.makeBasis
Matrix3.multiply
Matrix3.multiplyMatrices
Matrix3.multiplyScalar
Matrix3.offDiagonalFrobeniusNorm
Matrix3.premultiply
Matrix3.set
Matrix3.shurDecomposition
Matrix3.toArray
Matrix3.transpose
Matrix4
Matrix4.elements
Matrix4.clone
Matrix4.compose
Matrix4.copy
Matrix4.equals
Matrix4.extractBasis
Matrix4.fromArray
Matrix4.fromMatrix3
Matrix4.fromQuaternion
Matrix4.getInverse
Matrix4.getMaxScale
Matrix4.identity
Matrix4.makeBasis
Matrix4.multiply
Matrix4.multiplyMatrices
Matrix4.multiplyScalar
Matrix4.premultiply
Matrix4.scale
Matrix4.set
Matrix4.setPosition
Matrix4.toArray
Matrix4.transpose
MemoryRecord
MemoryRecord.entity
MemoryRecord.lastSensedPosition
MemoryRecord.timeBecameVisible
MemoryRecord.timeLastSensed
MemoryRecord.visible
MemoryRecord.fromJSON
MemoryRecord.resolveReferences
MemoryRecord.toJSON
MemorySystem
MemorySystem.memorySpan
MemorySystem.owner
MemorySystem.records
MemorySystem.recordsMap
MemorySystem.clear
MemorySystem.createRecord
MemorySystem.deleteRecord
MemorySystem.fromJSON
MemorySystem.getRecord
MemorySystem.getValidMemoryRecords
MemorySystem.hasRecord
MemorySystem.resolveReferences
MemorySystem.toJSON
MeshGeometry
MeshGeometry.aabb
MeshGeometry.backfaceCulling
MeshGeometry.boundingSphere
MeshGeometry.indices
MeshGeometry.vertices
MeshGeometry.computeBoundingVolume
MeshGeometry.fromJSON
MeshGeometry.intersectRay
MeshGeometry.toJSON
MeshGeometry.toTriangleSoup
MessageDispatcher
MessageDispatcher.delayedTelegrams
MessageDispatcher.clear
MessageDispatcher.deliver
MessageDispatcher.dispatch
MessageDispatcher.dispatchDelayedMessages
MessageDispatcher.fromJSON
MessageDispatcher.resolveReferences
MessageDispatcher.toJSON
MovingEntity
MovingEntity.active
MovingEntity.boundingRadius
MovingEntity.canActivateTrigger
MovingEntity.children
MovingEntity.forward
MovingEntity.manager
MovingEntity.maxSpeed
MovingEntity.maxTurnRate
MovingEntity.name
MovingEntity.neighborhoodRadius
MovingEntity.neighbors
MovingEntity.parent
MovingEntity.position
MovingEntity.rotation
MovingEntity.scale
MovingEntity.up
MovingEntity.updateNeighborhood
MovingEntity.updateOrientation
MovingEntity.uuid
MovingEntity.velocity
MovingEntity.worldMatrix
MovingEntity.add
MovingEntity.fromJSON
MovingEntity.getDirection
MovingEntity.getSpeed
MovingEntity.getSpeedSquared
MovingEntity.getWorldDirection
MovingEntity.getWorldPosition
MovingEntity.handleMessage
MovingEntity.lineOfSightTest
MovingEntity.lookAt
MovingEntity.remove
MovingEntity.resolveReferences
MovingEntity.rotateTo
MovingEntity.sendMessage
MovingEntity.setRenderComponent
MovingEntity.start
MovingEntity.toJSON
MovingEntity.update
NavEdge
NavEdge.cost
NavEdge.from
NavEdge.to
NavEdge.clone
NavEdge.copy
NavEdge.fromJSON
NavEdge.toJSON
NavMesh
NavMesh.epsilonContainsTest
NavMesh.epsilonCoplanarTest
NavMesh.graph
NavMesh.mergeConvexRegions
NavMesh.regions
NavMesh.spatialIndex
NavMesh.clampMovement
NavMesh.clear
NavMesh.findPath
NavMesh.fromPolygons
NavMesh.getClosestRegion
NavMesh.getNodeIndex
NavMesh.getRandomRegion
NavMesh.getRegionForPoint
NavMesh.updateSpatialIndex
NavMeshLoader
NavMeshLoader.load
NavMeshLoader.parse
NavNode
NavNode.index
NavNode.position
NavNode.userData
NavNode.fromJSON
NavNode.toJSON
Node
Node.index
Node.fromJSON
Node.toJSON
NormalDistFuzzySet
NormalDistFuzzySet.degreeOfMembership
NormalDistFuzzySet.left
NormalDistFuzzySet.midpoint
NormalDistFuzzySet.representativeValue
NormalDistFuzzySet.right
NormalDistFuzzySet.standardDeviation
NormalDistFuzzySet.uuid
NormalDistFuzzySet.clearDegreeOfMembership
NormalDistFuzzySet.computeDegreeOfMembership
NormalDistFuzzySet.fromJSON
NormalDistFuzzySet.getDegreeOfMembership
NormalDistFuzzySet.toJSON
NormalDistFuzzySet.updateDegreeOfMembership
OBB
OBB.center
OBB.halfSizes
OBB.rotation
OBB.clampPoint
OBB.clone
OBB.containsPoint
OBB.copy
OBB.equals
OBB.fromAABB
OBB.fromJSON
OBB.fromPoints
OBB.getSize
OBB.intersectsAABB
OBB.intersectsBoundingSphere
OBB.intersectsOBB
OBB.intersectsPlane
OBB.set
OBB.toJSON
ObstacleAvoidanceBehavior
ObstacleAvoidanceBehavior.active
ObstacleAvoidanceBehavior.brakingWeight
ObstacleAvoidanceBehavior.dBoxMinLength
ObstacleAvoidanceBehavior.obstacles
ObstacleAvoidanceBehavior.weight
ObstacleAvoidanceBehavior.calculate
ObstacleAvoidanceBehavior.fromJSON
ObstacleAvoidanceBehavior.resolveReferences
ObstacleAvoidanceBehavior.toJSON
OffsetPursuitBehavior
OffsetPursuitBehavior.active
OffsetPursuitBehavior.leader
OffsetPursuitBehavior.offset
OffsetPursuitBehavior.weight
OffsetPursuitBehavior.calculate
OffsetPursuitBehavior.fromJSON
OffsetPursuitBehavior.resolveReferences
OffsetPursuitBehavior.toJSON
OnPathBehavior
OnPathBehavior.active
OnPathBehavior.path
OnPathBehavior.predictionFactor
OnPathBehavior.radius
OnPathBehavior.weight
OnPathBehavior.calculate
OnPathBehavior.fromJSON
OnPathBehavior.resolveReferences
OnPathBehavior.toJSON
Path
Path.loop
Path.add
Path.advance
Path.clear
Path.current
Path.finished
Path.fromJSON
Path.toJSON
Plane
Plane.constant
Plane.normal
Plane.clone
Plane.copy
Plane.distanceToPoint
Plane.equals
Plane.fromCoplanarPoints
Plane.fromNormalAndCoplanarPoint
Plane.intersectPlane
Plane.intersectsPlane
Plane.projectPoint
Plane.set
Polygon
Polygon.centroid
Polygon.edge
Polygon.plane
Polygon.computeCentroid
Polygon.contains
Polygon.convex
Polygon.coplanar
Polygon.distanceToPoint
Polygon.fromContour
Polygon.getContour
Polyhedron
Polyhedron.centroid
Polyhedron.edges
Polyhedron.faces
Polyhedron.vertices
Polyhedron.computeCentroid
Polyhedron.computeUniqueEdges
Polyhedron.computeUniqueVertices
Polyhedron.fromAABB
PriorityQueue
PriorityQueue.compare
PriorityQueue.data
PriorityQueue.length
PriorityQueue.peek
PriorityQueue.pop
PriorityQueue.push
PursuitBehavior
PursuitBehavior.active
PursuitBehavior.evader
PursuitBehavior.predictionFactor
PursuitBehavior.weight
PursuitBehavior.calculate
PursuitBehavior.fromJSON
PursuitBehavior.resolveReferences
PursuitBehavior.toJSON
Quaternion
Quaternion.w
Quaternion.x
Quaternion.y
Quaternion.z
Quaternion.angleTo
Quaternion.clone
Quaternion.conjugate
Quaternion.copy
Quaternion.dot
Quaternion.equals
Quaternion.extractRotationFromMatrix
Quaternion.fromArray
Quaternion.fromEuler
Quaternion.fromMatrix3
Quaternion.inverse
Quaternion.length
Quaternion.lookAt
Quaternion.multiply
Quaternion.multiplyQuaternions
Quaternion.normalize
Quaternion.premultiply
Quaternion.rotateTo
Quaternion.set
Quaternion.slerp
Quaternion.squaredLength
Quaternion.toArray
Quaternion.toEuler
Ray
Ray.direction
Ray.origin
Ray.applyMatrix4
Ray.at
Ray.clone
Ray.copy
Ray.equals
Ray.intersectAABB
Ray.intersectBoundingSphere
Ray.intersectBVH
Ray.intersectConvexHull
Ray.intersectOBB
Ray.intersectPlane
Ray.intersectsAABB
Ray.intersectsBoundingSphere
Ray.intersectsBVH
Ray.intersectsConvexHull
Ray.intersectsOBB
Ray.intersectsPlane
Ray.intersectTriangle
Ray.set
RectangleTriggerRegion
RectangleTriggerRegion.size
RectangleTriggerRegion.fromJSON
RectangleTriggerRegion.toJSON
RectangleTriggerRegion.touching
RectangleTriggerRegion.update
Regular
Regular.updateFrequency
Regular.ready
RightSCurveFuzzySet
RightSCurveFuzzySet.degreeOfMembership
RightSCurveFuzzySet.left
RightSCurveFuzzySet.midpoint
RightSCurveFuzzySet.representativeValue
RightSCurveFuzzySet.right
RightSCurveFuzzySet.uuid
RightSCurveFuzzySet.clearDegreeOfMembership
RightSCurveFuzzySet.computeDegreeOfMembership
RightSCurveFuzzySet.fromJSON
RightSCurveFuzzySet.getDegreeOfMembership
RightSCurveFuzzySet.toJSON
RightSCurveFuzzySet.updateDegreeOfMembership
RightShoulderFuzzySet
RightShoulderFuzzySet.degreeOfMembership
RightShoulderFuzzySet.left
RightShoulderFuzzySet.midpoint
RightShoulderFuzzySet.representativeValue
RightShoulderFuzzySet.right
RightShoulderFuzzySet.uuid
RightShoulderFuzzySet.clearDegreeOfMembership
RightShoulderFuzzySet.computeDegreeOfMembership
RightShoulderFuzzySet.fromJSON
RightShoulderFuzzySet.getDegreeOfMembership
RightShoulderFuzzySet.toJSON
RightShoulderFuzzySet.updateDegreeOfMembership
SAT
SAT.intersects
SeekBehavior
SeekBehavior.active
SeekBehavior.target
SeekBehavior.weight
SeekBehavior.calculate
SeekBehavior.fromJSON
SeekBehavior.resolveReferences
SeekBehavior.toJSON
SeparationBehavior
SeparationBehavior.active
SeparationBehavior.weight
SeparationBehavior.calculate
SeparationBehavior.fromJSON
SeparationBehavior.resolveReferences
SeparationBehavior.toJSON
SingletonFuzzySet
SingletonFuzzySet.degreeOfMembership
SingletonFuzzySet.left
SingletonFuzzySet.midpoint
SingletonFuzzySet.representativeValue
SingletonFuzzySet.right
SingletonFuzzySet.uuid
SingletonFuzzySet.clearDegreeOfMembership
SingletonFuzzySet.computeDegreeOfMembership
SingletonFuzzySet.fromJSON
SingletonFuzzySet.getDegreeOfMembership
SingletonFuzzySet.toJSON
SingletonFuzzySet.updateDegreeOfMembership
Smoother
Smoother.count
Smoother.calculate
Smoother.fromJSON
Smoother.toJSON
SphericalTriggerRegion
SphericalTriggerRegion.radius
SphericalTriggerRegion.fromJSON
SphericalTriggerRegion.toJSON
SphericalTriggerRegion.touching
SphericalTriggerRegion.update
State
State.enter
State.execute
State.exit
State.fromJSON
State.onMessage
State.resolveReferences
State.toJSON
StateMachine
StateMachine.currentState
StateMachine.globalState
StateMachine.owner
StateMachine.previousState
StateMachine.states
StateMachine.add
StateMachine.changeTo
StateMachine.fromJSON
StateMachine.get
StateMachine.handleMessage
StateMachine.in
StateMachine.registerType
StateMachine.remove
StateMachine.resolveReferences
StateMachine.revert
StateMachine.toJSON
StateMachine.update
SteeringBehavior
SteeringBehavior.active
SteeringBehavior.weight
SteeringBehavior.calculate
SteeringBehavior.fromJSON
SteeringBehavior.resolveReferences
SteeringBehavior.toJSON
SteeringManager
SteeringManager.behaviors
SteeringManager.vehicle
SteeringManager.add
SteeringManager.calculate
SteeringManager.clear
SteeringManager.fromJSON
SteeringManager.registerType
SteeringManager.remove
SteeringManager.resolveReferences
SteeringManager.toJSON
Task
Task.execute
TaskQueue
TaskQueue.options
TaskQueue.tasks
TaskQueue.enqueue
TaskQueue.update
Telegram
Telegram.data
Telegram.delay
Telegram.message
Telegram.receiver
Telegram.sender
Telegram.fromJSON
Telegram.resolveReferences
Telegram.toJSON
Think
Think.evaluators
Think.owner
Think.status
Think.subgoals
Think.activate
Think.activateIfInactive
Think.active
Think.addEvaluator
Think.addSubgoal
Think.arbitrate
Think.clearSubgoals
Think.completed
Think.currentSubgoal
Think.execute
Think.executeSubgoals
Think.failed
Think.fromJSON
Think.handleMessage
Think.hasSubgoals
Think.inactive
Think.registerType
Think.removeEvaluator
Think.removeSubgoal
Think.replanIfFailed
Think.resolveReferences
Think.terminate
Think.toJSON
Time
Time.disableFixedDelta
Time.dispose
Time.enableFixedDelta
Time.getDelta
Time.getElapsed
Time.getFixedDelta
Time.getTimescale
Time.reset
Time.setFixedDelta
Time.setTimescale
Time.update
TriangularFuzzySet
TriangularFuzzySet.degreeOfMembership
TriangularFuzzySet.left
TriangularFuzzySet.midpoint
TriangularFuzzySet.representativeValue
TriangularFuzzySet.right
TriangularFuzzySet.uuid
TriangularFuzzySet.clearDegreeOfMembership
TriangularFuzzySet.computeDegreeOfMembership
TriangularFuzzySet.fromJSON
TriangularFuzzySet.getDegreeOfMembership
TriangularFuzzySet.toJSON
TriangularFuzzySet.updateDegreeOfMembership
Trigger
Trigger.active
Trigger.boundingRadius
Trigger.canActivateTrigger
Trigger.children
Trigger.forward
Trigger.manager
Trigger.maxTurnRate
Trigger.name
Trigger.neighborhoodRadius
Trigger.neighbors
Trigger.parent
Trigger.position
Trigger.region
Trigger.rotation
Trigger.scale
Trigger.up
Trigger.updateNeighborhood
Trigger.uuid
Trigger.worldMatrix
Trigger.add
Trigger.check
Trigger.execute
Trigger.fromJSON
Trigger.getDirection
Trigger.getWorldDirection
Trigger.getWorldPosition
Trigger.handleMessage
Trigger.lineOfSightTest
Trigger.lookAt
Trigger.registerType
Trigger.remove
Trigger.resolveReferences
Trigger.rotateTo
Trigger.sendMessage
Trigger.setRenderComponent
Trigger.start
Trigger.toJSON
Trigger.update
Trigger.updateRegion
TriggerRegion
TriggerRegion.fromJSON
TriggerRegion.toJSON
TriggerRegion.touching
TriggerRegion.update
Vector3
Vector3.x
Vector3.y
Vector3.z
Vector3.add
Vector3.addScalar
Vector3.addVectors
Vector3.angleTo
Vector3.applyMatrix4
Vector3.applyRotation
Vector3.clamp
Vector3.clone
Vector3.copy
Vector3.cross
Vector3.crossVectors
Vector3.distanceTo
Vector3.divide
Vector3.divideScalar
Vector3.divideVectors
Vector3.dot
Vector3.equals
Vector3.extractPositionFromMatrix
Vector3.fromArray
Vector3.fromMatrix3Column
Vector3.fromMatrix4Column
Vector3.fromSpherical
Vector3.length
Vector3.manhattanDistanceTo
Vector3.manhattanLength
Vector3.max
Vector3.min
Vector3.multiply
Vector3.multiplyScalar
Vector3.multiplyVectors
Vector3.normalize
Vector3.reflect
Vector3.set
Vector3.squaredDistanceTo
Vector3.squaredLength
Vector3.sub
Vector3.subScalar
Vector3.subVectors
Vector3.toArray
Vector3.transformDirection
Vehicle
Vehicle.active
Vehicle.boundingRadius
Vehicle.canActivateTrigger
Vehicle.children
Vehicle.forward
Vehicle.manager
Vehicle.mass
Vehicle.maxForce
Vehicle.maxSpeed
Vehicle.maxTurnRate
Vehicle.name
Vehicle.neighborhoodRadius
Vehicle.neighbors
Vehicle.parent
Vehicle.position
Vehicle.rotation
Vehicle.scale
Vehicle.smoother
Vehicle.steering
Vehicle.up
Vehicle.updateNeighborhood
Vehicle.updateOrientation
Vehicle.uuid
Vehicle.velocity
Vehicle.worldMatrix
Vehicle.add
Vehicle.fromJSON
Vehicle.getDirection
Vehicle.getSpeed
Vehicle.getSpeedSquared
Vehicle.getWorldDirection
Vehicle.getWorldPosition
Vehicle.handleMessage
Vehicle.lineOfSightTest
Vehicle.lookAt
Vehicle.remove
Vehicle.resolveReferences
Vehicle.rotateTo
Vehicle.sendMessage
Vehicle.setRenderComponent
Vehicle.start
Vehicle.toJSON
Vehicle.update
Version
Version.fieldOfView
Version.obstacles
Version.owner
Version.range
Version.addObstacle
Version.fromJSON
Version.removeObstacle
Version.resolveReferences
Version.toJSON
Version.visible
WanderBehavior
WanderBehavior.active
WanderBehavior.distance
WanderBehavior.jitter
WanderBehavior.radius
WanderBehavior.weight
WanderBehavior.calculate
WanderBehavior.fromJSON
WanderBehavior.resolveReferences
WanderBehavior.toJSON
选择文档
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
0
deleteRecord
该方法用于从内存中删除一条记录。
参数
id
:必选,String类型,要删除的记录的唯一标识符。
返回值
无返回值。
示例
Yuka
.
MemorySystem
.
deleteRecord
(
"12345"
);
注意事项
删除一条记录后,如果该记录在内存中不存在,不会报错,仅仅没有任何动作。
删除一条记录后,如果该记录已经被其他部分使用,可能会导致错误,因此建议仅仅在没有任何地方使用该记录的情况下进行删除。