A B C D E F G H I J K L M N O P R S T U V W X Y Z _

A

A - Variable in class lejos.nxt.addon.PFMate
 
A - Variable in class lejos.nxt.addon.RCXLink
 
A - Variable in class lejos.nxt.addon.RCXMotorMultiplexer
 
A - Static variable in class lejos.nxt.Motor
Motor A.
A - Static variable in class lejos.nxt.MotorPort
 
Accelerometer - Interface in lejos.robotics
Interface for Acceleration sensors
AccelHTSensor - Class in lejos.nxt.addon
This class works with the HiTechnic acceleration sensor.
AccelHTSensor(I2CPort) - Constructor for class lejos.nxt.addon.AccelHTSensor
 
AccelHTSensor(I2CPort, int) - Constructor for class lejos.nxt.addon.AccelHTSensor
 
AccelMindSensor - Class in lejos.nxt.addon
This class works with the Mindsensors acceleration (tilt) sensor.
AccelMindSensor(I2CPort) - Constructor for class lejos.nxt.addon.AccelMindSensor
 
AccelMindSensor(I2CPort, int) - Constructor for class lejos.nxt.addon.AccelMindSensor
 
actionPerformed(ActionEvent) - Method in class lejos.pc.comm.RemoteFrame
Process buttons
activate() - Method in class lejos.nxt.addon.RCXLightSensor
Deprecated. Use RCXLightSensor.setFloodlight(boolean) with true instead
activate() - Method in interface lejos.nxt.LegacySensorPort
 
activate() - Method in class lejos.nxt.SensorPort
Activate an RCX Light Sensor
add(Point) - Method in class lejos.geom.Point
 
addDCMotor(int, String) - Method in class lejos.nxt.addon.LSC
Method to add a DC Motor
addDCMotor(int, String, int, int, int, int) - Method in class lejos.nxt.addon.LSC
Method to add a DC Motor
addDetector(FeatureDetector) - Method in class lejos.robotics.objectdetection.FusorDetector
This method adds another FeatureDetector to the FusorDetector.
addListener(RegulatedMotorListener) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Add a motor listener.
addListener(RegulatedMotorListener) - Method in class lejos.nxt.remote.RemoteMotor
Currently not completely implemented in RemoteMotor!
addListener(WayPointListener) - Method in class lejos.robotics.navigation.NavPathController
 
addListener(WayPointListener) - Method in interface lejos.robotics.navigation.PathController
Adds a WayPointListener that will be notified with the actual waypoint it reached.
addListener(FeatureListener) - Method in interface lejos.robotics.objectdetection.FeatureDetector
Adds a listener to the FeatureDetector.
addListener(FeatureListener) - Method in class lejos.robotics.objectdetection.FeatureDetectorAdapter
 
addListener(FeatureListener) - Method in class lejos.robotics.objectdetection.FusorDetector
 
addListener(WayPointListener) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
 
addListener(WayPointListener) - Method in class lejos.robotics.pathfinding.NodePathFinder
 
addListener(WayPointListener) - Method in interface lejos.robotics.pathfinding.PathFinder
 
addListener(WayPointListener) - Method in class lejos.robotics.pathfinding.RandomPathFinder
 
addListener(WayPointListener) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
addListener(RegulatedMotorListener) - Method in interface lejos.robotics.RegulatedMotor
Adds a listener object that will be notified when rotation has started or stopped
addLogListener(NXTCommLogListener) - Method in class lejos.pc.comm.NXTCommLoggable
register log listener
addLogListener(NXTCommLogListener) - Method in class lejos.pc.comm.NXTConnectionManager
register log listener
addLSC(int) - Method in class lejos.nxt.addon.NXTe
Add a LSC, Lattebox Servo Controller
addMoveListener(MoveListener) - Method in class lejos.robotics.navigation.DifferentialPilot
 
addMoveListener(MoveListener) - Method in interface lejos.robotics.navigation.MoveProvider
Adds a MoveListener that will be notified of all movement events.
addMoveListener(MoveListener) - Method in class lejos.robotics.navigation.SteeringPilot
 
addNeighbor(Node) - Method in class lejos.robotics.pathfinding.Node
Adds a neighboring node to this node, connecting them together.
addNode(Node, int) - Method in class lejos.robotics.pathfinding.FourWayGridMesh
Adds a node to this set and connects it with a number of neighboring nodes.
addNode(Node, int) - Method in interface lejos.robotics.pathfinding.NavigationMesh
Adds a node to this set and connects it with a number of neighboring nodes.
address - Static variable in class lejos.nxt.addon.IRSeekerV2
 
address - Variable in class lejos.nxt.I2CSensor
 
addServo(int, String) - Method in class lejos.nxt.addon.LSC
Method to add a RC servo to current LSC
addServo(int, String, int, int) - Method in class lejos.nxt.addon.LSC
Method to add a RC servo to current LSC
addTargetListener(WayPointListener) - Method in class lejos.robotics.navigation.NavPathController
 
addTargetListener(WayPointListener) - Method in interface lejos.robotics.navigation.PathController
Adds a waypoint listener that will be notified with the theoretical target waypoint it reached.
addWayPoint(WayPoint) - Method in class lejos.robotics.navigation.NavPathController
 
addWayPoint(WayPoint) - Method in interface lejos.robotics.navigation.PathController
Adds a WayPoint to the route.
addWith(Point) - Method in class lejos.geom.Point
 
ADSensorPort - Interface in lejos.nxt
An abstraction for a port that supports Analog/Digital sensors.
ALL_PROTOCOLS - Static variable in class lejos.pc.comm.NXTCommFactory
 
allChannelsOff() - Method in class lejos.nxt.addon.RCXSensorMultiplexer
Turns off all channels
ALWAYS_ACTIVE - Static variable in interface lejos.nxt.I2CPort
 
angle() - Method in class lejos.geom.Point
 
ANGLE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
angles - Variable in class lejos.robotics.FixedRangeScanner
 
angles - Variable in class lejos.robotics.RotatingRangeScanner
 
AngleSensor - Class in lejos.nxt.addon
Supports the angle sensor of HiTechnic.
AngleSensor(I2CPort, int, int, int) - Constructor for class lejos.nxt.addon.AngleSensor
 
AngleSensor(I2CPort, int) - Constructor for class lejos.nxt.addon.AngleSensor
 
AngleSensor(I2CPort) - Constructor for class lejos.nxt.addon.AngleSensor
 
ANGLESTEPSMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
angleTo(Point) - Method in class lejos.geom.Point
Returns the direction angle from this point to the Point p
angleTo(float, float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Returns the direction angle from robot current location to the point with coordinates x,y
angleTo(Point) - Method in class lejos.robotics.navigation.Pose
Returns the angle with respect to the X axis to APPEND_NOT_POSSIBLE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
applyMove(Move, float, float) - Method in class lejos.robotics.localization.MCLParticle
Apply the robot's move to the particle with a bit of random noise.
applyMove(Move) - Method in class lejos.robotics.localization.MCLParticleSet
Apply a move to each particle
arc(double, double) - Method in interface lejos.robotics.navigation.ArcMoveController
Moves the NXT robot along an arc with a specified radius and angle, after which the robot stops moving.
arc(double, double, boolean) - Method in interface lejos.robotics.navigation.ArcMoveController
Moves the NXT robot along an arc with a specified radius and angle, after which the robot stops moving.
arc(double, double) - Method in class lejos.robotics.navigation.DifferentialPilot
 
arc(double, double, boolean) - Method in class lejos.robotics.navigation.DifferentialPilot
 
arc(float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Starts the NXT robot moving in a circular path with a specified radius;
The center of the turning circle is on the left side of the robot if parameter radius is positive and on the right if negative.
arc(float, int) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Moves the NXT robot in a circular arc through the specified angle;
The center of the turning circle is on the left side of the robot if parameter radius is positive and on the right if negative.
arc(float, int, boolean) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Moves the NXT robot in a circular arc through a specific angle;
The center of the turning circle is on the left side of the robot if parameter radius is positive and on the right if negative.
arc(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
arc(float, float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
arc(float, float, boolean) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
arc(double, double) - Method in class lejos.robotics.navigation.SteeringPilot
 
arc(double, double, boolean) - Method in class lejos.robotics.navigation.SteeringPilot
 
ArcAlgorithms - Class in lejos.robotics.navigation
The static methods in this class can be used to to calculate theoretical routes and for displaying graphical representations of the path of a robot.
arcBackward(double) - Method in interface lejos.robotics.navigation.ArcMoveController
Starts the NXT robot moving backward along an arc with a specified radius.
arcBackward(double) - Method in class lejos.robotics.navigation.DifferentialPilot
 
arcBackward(double) - Method in class lejos.robotics.navigation.SteeringPilot
 
arcForward(double) - Method in interface lejos.robotics.navigation.ArcMoveController
Starts the NXT robot moving forward along an arc with a specified radius.
arcForward(double) - Method in class lejos.robotics.navigation.DifferentialPilot
 
arcForward(double) - Method in class lejos.robotics.navigation.SteeringPilot
 
ARCH_ARM - Static variable in class lejos.util.jni.OSInfo
 
ARCH_PA_RISK - Static variable in class lejos.util.jni.OSInfo
 
ARCH_PPC - Static variable in class lejos.util.jni.OSInfo
 
ARCH_PPC64 - Static variable in class lejos.util.jni.OSInfo
 
ARCH_SPARC - Static variable in class lejos.util.jni.OSInfo
 
ARCH_X86 - Static variable in class lejos.util.jni.OSInfo
 
ARCH_X86_64 - Static variable in class lejos.util.jni.OSInfo
 
ArcMoveController - Interface in lejos.robotics.navigation
An enhanced MoveController that is capable of traveling in arcs.
ArcRotateMoveController - Interface in lejos.robotics.navigation
A MoveController for robots that can perform arcs and rotate on the spot.
arcUpdate(float, float) - Method in class lejos.robotics.navigation.Pose
Sets the pose locatin and heading to the currect values resulting from travel in a circular arc.
arrayLeftDivide(Matrix) - Method in class lejos.util.Matrix
Element-by-element left division, C = A.\B
arrayLeftDivideEquals(Matrix) - Method in class lejos.util.Matrix
Element-by-element left division in place, A = A.\B
arrayRightDivide(Matrix) - Method in class lejos.util.Matrix
Element-by-element right division, C = A./B
arrayRightDivideEquals(Matrix) - Method in class lejos.util.Matrix
Element-by-element right division in place, A = A./B
arrayTimes(Matrix) - Method in class lejos.util.Matrix
Element-by-element multiplication, C = A.*B
arrayTimesEquals(Matrix) - Method in class lejos.util.Matrix
 
arrMotorLoad - Static variable in class lejos.nxt.addon.LMotor
 
arrMotorUnload - Static variable in class lejos.nxt.addon.LMotor
 
arrowLength - Variable in class lejos.pc.comm.MCLPanel
 
AsciizCodec - Class in lejos.nxt.remote
Methods to encode and decode ASCIIZ.
AstarSearchAlgorithm - Class in lejos.robotics.pathfinding
This is an implementation of the A* search algorithm.
AstarSearchAlgorithm() - Constructor for class lejos.robotics.pathfinding.AstarSearchAlgorithm
 
atEndOfLine(Line) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
test if this Node is one of the ends of theLine
atEndOfLine(Line) - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
test if this Node is one of the ends of theLine
ATTEMPTED_TO_ACCESS_INVALID_FIELD_OF_A_STRUCTURE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
autoUpdate(boolean) - Method in class lejos.robotics.localization.MCLPoseProvider
If yes: after a Travel move, the range scanner is requested to get range readings, which are then used to update the particle weights.
available() - Method in interface lejos.pc.comm.NXTComm
Request the number of bytes available to read.
available() - Method in class lejos.pc.comm.NXTCommBluecove
 
available() - Method in class lejos.pc.comm.NXTCommBluez
 
available() - Method in class lejos.pc.comm.NXTCommInputStream
returns the number of bytes in the input buffer - can be read without blocking
available() - Method in class lejos.pc.comm.NXTCommUSB
The number of bytes that can be read without blocking.

B

B - Variable in class lejos.nxt.addon.PFMate
 
B - Variable in class lejos.nxt.addon.RCXLink
 
B - Variable in class lejos.nxt.addon.RCXMotorMultiplexer
 
B - Static variable in class lejos.nxt.Motor
Motor B.
B - Static variable in class lejos.nxt.MotorPort
 
backward() - Method in class lejos.nxt.addon.LServo
Classic backward method for continous RC Servos
backward() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Causes motor to rotate backwards.
backward() - Method in class lejos.nxt.addon.NXTMMXMotor
Causes motor to rotate backwards.
backward() - Method in class lejos.nxt.addon.PFMateMotor
Runs the motor backward
backward(int) - Method in class lejos.nxt.addon.RCXLink
 
backward() - Method in class lejos.nxt.BasicMotor
Causes motor to rotate backwards.
BACKWARD - Static variable in interface lejos.nxt.BasicMotorPort
Motor is running backwards
backward() - Method in class lejos.nxt.remote.RemoteMotor
 
backward() - Method in interface lejos.robotics.BaseMotor
Causes motor to rotate backwards until stop() or flt() is called.
backward() - Method in class lejos.robotics.navigation.DifferentialPilot
Starts the NXT robot moving backward.
backward() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
backward() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
backward() - Method in interface lejos.robotics.navigation.MoveController
Starts the NXT robot moving backwards.
backward() - Method in class lejos.robotics.navigation.SteeringPilot
 
backwardStep(int) - Method in class lejos.nxt.addon.IRLink
 
backwardStep(int) - Method in interface lejos.nxt.addon.IRTransmitter
 
backwardStep(int) - Method in class lejos.nxt.addon.RCXLink
 
BAD_ARGUMENTS - Static variable in interface lejos.nxt.remote.ErrorMessages
 
BAD_INPUT_OR_OUTPUT_SPECIFIED - Static variable in interface lejos.nxt.remote.ErrorMessages
 
BaseMotor - Interface in lejos.robotics
Base motor interface.
BasicMotor - Class in lejos.nxt
Abstraction for basic motor operations.
BasicMotor() - Constructor for class lejos.nxt.BasicMotor
 
BasicMotorPort - Interface in lejos.nxt
An abstraction for a motor port that supports RCX type motors, but not NXT motors with tachometers.
BasicSensorPort - Interface in lejos.nxt
An abstraction for a sensor port that supports setting and retrieving types and modes of sensors.
Battery - Class in lejos.nxt
Battery class that supports remote execution.
beep() - Method in class lejos.nxt.addon.IRLink
 
beep() - Method in interface lejos.nxt.addon.IRTransmitter
 
BEEP - Static variable in class lejos.nxt.addon.RCXLink
NOTE: The BEEP macro is unreliable.
beep() - Method in class lejos.nxt.addon.RCXLink
 
BLACK - Static variable in interface lejos.nxt.SensorConstants
Colors used as the output value when in full mode.
BLACK - Static variable in class lejos.robotics.Color
 
BLANK_INDEX - Static variable in interface lejos.nxt.SensorConstants
Color sensor data BLANK/Background value index.
block(DijkstraPathFinder.Node) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
add aNode to list of nodes not a neighbour of this Node
block(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
add aNode to list of nodes not a neighbour of this Node
blockTachoCount - Variable in class lejos.nxt.remote.OutputState
 
BLUE - Static variable in interface lejos.nxt.SensorConstants
 
BLUE - Static variable in class lejos.robotics.Color
 
BLUE_INDEX - Static variable in interface lejos.nxt.SensorConstants
Color sensor data BLUE value index.
BLUETOOTH - Static variable in class lejos.pc.comm.NXTCommFactory
 
bluetoothAddress - Variable in class lejos.nxt.remote.DeviceInfo
 
BlueZException - Exception in lejos.pc.comm
Exception thrown by the jbluez library.
BlueZException() - Constructor for exception lejos.pc.comm.BlueZException
 
BlueZException(String) - Constructor for exception lejos.pc.comm.BlueZException
 
BOOLEANMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
boot() - Method in class lejos.nxt.remote.NXTCommand
Put the NXT into SAMBA mode, ready to update the firmware
BOOT - Static variable in interface lejos.nxt.remote.NXTProtocol
 
boundingRect - Variable in class lejos.pc.comm.MapPanel
 
BRAKE - Static variable in interface lejos.nxt.remote.NXTProtocol
Use run/brake instead of run/float in PWM
bytesAvailable() - Method in class lejos.nxt.addon.RCXLink
 

C

C - Variable in class lejos.nxt.addon.RCXLink
 
C - Variable in class lejos.nxt.addon.RCXMotorMultiplexer
 
C - Static variable in class lejos.nxt.Motor
Motor C.
C - Static variable in class lejos.nxt.MotorPort
 
calculateG(Node) - Method in class lejos.robotics.pathfinding.GridNode
 
calculateG(Node) - Method in class lejos.robotics.pathfinding.Node
Calculates the distance to a neighbor node.
calculateH(Node) - Method in class lejos.robotics.pathfinding.GridNode
 
calculateH(Node) - Method in class lejos.robotics.pathfinding.Node
Calculates the distance to the goal node.
calculateWeight(RangeReadings, RangeMap, float) - Method in class lejos.robotics.localization.MCLParticle
Calculate the weight for this particle by comparing its readings with the robot's readings
calculateWeights(RangeReadings, RangeMap) - Method in class lejos.robotics.localization.MCLParticleSet
Calculate the weight for each particle
calibrate() - Method in class lejos.nxt.addon.LSC
This method check LSC connected with NXTe Currently I am debugging
calibrate(NXTLineLeader.LineColor) - Method in class lejos.nxt.addon.NXTLineLeader
Calibrate the white and black levels.
calibrate() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Rotates the robot 360 degrees while calibrating the compass resets compass zero to heading at end of calibration
calibrateAngle() - Method in class lejos.nxt.addon.AngleSensor
Calibrate the zero position of angle.
calibratedValue - Variable in class lejos.nxt.remote.InputValues
Currently unused.
calibrateHigh() - Method in class lejos.nxt.addon.RCXLightSensor
call this method when the light sensor is reading the high value - used by readValue
calibrateHigh() - Method in class lejos.nxt.ColorSensor
call this method when the light sensor is reading the high value - used by readValue
calibrateHigh() - Method in class lejos.nxt.LightSensor
call this method when the light sensor is reading the high value - used by readValue
calibrateLow() - Method in class lejos.nxt.addon.RCXLightSensor
call this method when the light sensor is reading the low value - used by readValue
calibrateLow() - Method in class lejos.nxt.ColorSensor
call this method when the light sensor is reading the low value - used by readValue
calibrateLow() - Method in class lejos.nxt.LightSensor
call this method when the light sensor is reading the low value - used by readValue
capture() - Method in class lejos.nxt.UltrasonicSensor
Set capture mode Set the sensor into capture mode.
CELSIUSMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
checkValidity(Pose) - Method in class lejos.robotics.navigation.WayPoint
Check that the given pose satisfies the conditions for this way point
Clock - Interface in lejos.robotics
Interface for real time clock devices
clone() - Method in class lejos.geom.Point
 
clone() - Method in class lejos.util.Matrix
Clone the Matrix object.
close() - Method in class lejos.nxt.rcxcomm.PacketHandler
Close this packet handler and all lower layers.
close() - Method in class lejos.nxt.rcxcomm.RCXAbstractPort
Closes this RCXPort, stopping the Listener thread.
close() - Method in class lejos.nxt.remote.NXTCommand
Call the close() command when your program ends, otherwise you will have to turn the NXT brick off/on before you run another program.
close() - Method in interface lejos.nxt.remote.NXTCommRequest
Close the connection
CLOSE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
close() - Method in class lejos.pc.comm.NXTCommBluecove
 
close() - Method in class lejos.pc.comm.NXTCommBluez
 
close() - Method in class lejos.pc.comm.NXTCommInputStream
Close the stream
close() - Method in class lejos.pc.comm.NXTCommUSB
Close the current device.
close() - Method in class lejos.pc.comm.NXTConnector
Close the connection
close() - Method in class lejos.pc.comm.NXTSamba
Close the device.
closeAll() - Method in class lejos.pc.comm.NXTConnectionManager
 
closeFile(byte) - Method in class lejos.nxt.remote.NXTCommand
Closes an open file.
closest - Variable in class lejos.pc.comm.MCLPanel
 
COLOR - Static variable in class lejos.nxt.addon.NXTCam
Used by sortBy() to choose sorting criteria based on color id (ordered 0 to 7).
Color - Class in lejos.robotics
Representation of a color, used by color sensors and color detectors.
Color(int, int, int) - Constructor for class lejos.robotics.Color
 
Color(int, int, int, int) - Constructor for class lejos.robotics.Color
 
ColorDetector - Interface in lejos.robotics
This interface defines the methods of a generic ColorDetector object.
colorMap - Static variable in class lejos.nxt.ColorSensor
 
ColorSensor - Class in lejos.nxt
LEGO Color Sensor driver.
ColorSensor(SensorPort) - Constructor for class lejos.nxt.ColorSensor
Create a new Color Sensor instance and bind it to a port.
ColorSensor(SensorPort, int) - Constructor for class lejos.nxt.ColorSensor
Create a new Color Sensor instance and bind it to a port.
ColorSensor.Color - Class in lejos.nxt
Extended color class, that includes the background reading at the time that the other readings were made.
ColorSensor.Color(int, int, int, int, int) - Constructor for class lejos.nxt.ColorSensor.Color
 
ColorSensorHT - Class in lejos.nxt.addon
HiTechnic color sensor.
www.hitechnic.com
ColorSensorHT(I2CPort) - Constructor for class lejos.nxt.addon.ColorSensorHT
 
COMBO_CH1_A_FORWARD_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH1_A_FORWARD_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH1_A_REVERSE_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH1_A_REVERSE_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH2_A_FORWARD_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH2_A_FORWARD_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH2_A_REVERSE_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH2_A_REVERSE_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH3_A_FORWARD_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH3_A_FORWARD_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH3_A_REVERSE_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH3_A_REVERSE_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH4_A_FORWARD_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH4_A_FORWARD_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH4_A_REVERSE_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
COMBO_CH4_A_REVERSE_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
COMMUNICATION_BUS_ERROR - Static variable in interface lejos.nxt.remote.ErrorMessages
 
compass - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
CompassPilot - Class in lejos.robotics.navigation
Deprecated. This class will disappear in NXJ version 1.0. Compass should be added to a PoseProvider.
CompassPilot(DirectionFinder, float, float, RegulatedMotor, RegulatedMotor) - Constructor for class lejos.robotics.navigation.CompassPilot
Deprecated. Allocates a CompasPilot object, and sets the physical parameters of the NXT robot.
CompassPilot(DirectionFinder, float, float, RegulatedMotor, RegulatedMotor, boolean) - Constructor for class lejos.robotics.navigation.CompassPilot
Deprecated. Allocates a CompasPilot object, and sets the physical parameters of the NXT robot.
CompassSensor - Class in lejos.nxt.addon
Abstraction for a HiTechnic or Mindsensors compass.
CompassSensor(I2CPort, int) - Constructor for class lejos.nxt.addon.CompassSensor
Create a compass sensor object
CompassSensor(I2CPort) - Constructor for class lejos.nxt.addon.CompassSensor
Create a compass sensor object
configurate() - Method in class lejos.nxt.addon.SensorMux
This method is necessary to execute to connect sensors on it
connect() - Method in class lejos.pc.comm.RemoteFrame
Connect to the NXT
connect(Node, Node) - Method in class lejos.robotics.pathfinding.FourWayGridMesh
 
connect(Node, Node) - Method in interface lejos.robotics.pathfinding.NavigationMesh
Attempts to connect two nodes together by adding them as neighbors.
connectionState - Variable in class lejos.pc.comm.NXTInfo
the present connection state of the NXT
connectTo() - Method in class lejos.pc.comm.NXTConnector
Connect to any NXT over any protocol in PACKET mode
connectTo(int) - Method in class lejos.pc.comm.NXTConnector
Connect to any NXT over any protocol specifying mode
connectTo(String, String, int) - Method in class lejos.pc.comm.NXTConnector
Connect to a specified NXT in packet mode
connectTo(String, String, int, int) - Method in class lejos.pc.comm.NXTConnector
Connect to a NXT
connectTo(NXTInfo, int) - Method in class lejos.pc.comm.NXTConnector
Connect to a NXT using a NXTInfo
connectTo(String, int) - Method in class lejos.pc.comm.NXTConnector
Connect to a device by URL
connectTo(String) - Method in class lejos.pc.comm.NXTConnector
Connect to a device by URL in packet mode
connectToBrick(NXTInfo) - Method in class lejos.pc.comm.NXTConnectionManager
connects to a NXT brick
constructWithCopy(double[][]) - Static method in class lejos.util.Matrix
Construct a matrix from a copy of a 2-D array.
continuous() - Method in class lejos.nxt.UltrasonicSensor
Switch to continuous mode.
controlMotor(int, int) - Method in class lejos.nxt.addon.PFMotorPort
 
controlMotor(int, int) - Method in class lejos.nxt.addon.RCXPlexedMotorPort
 
controlMotor(int, int) - Method in class lejos.nxt.addon.RCXRemoteMotorPort
 
controlMotor(int, int) - Method in interface lejos.nxt.BasicMotorPort
 
controlMotor(int, int) - Method in class lejos.nxt.MotorPort
 
controlMotor(int, int) - Method in class lejos.nxt.remote.RemoteMotorPort
 
convertAngleToDistance(float, float) - Static method in class lejos.robotics.navigation.Move
Static utility method for converting angle (given turn radius) into distance.
convertDistanceToAngle(float, float) - Static method in class lejos.robotics.navigation.Move
Static utility method for converting distance (given turn radius) into angle.
copy() - Method in class lejos.util.Matrix
Make a deep copy of a matrix
copyTo(Point) - Method in class lejos.geom.Point
 
count - Variable in class lejos.nxt.addon.RCXRotationSensor
 
createAccelerometer(I2CPort) - Static method in class lejos.nxt.addon.SensorSelector
 
createButton(String) - Method in class lejos.pc.comm.RemoteFrame
 
createInputStream(int, int) - Method in class lejos.pc.comm.NXTSamba
 
createIRTransmitter(I2CPort) - Static method in class lejos.nxt.addon.SensorSelector
 
createNXTComm(int) - Static method in class lejos.pc.comm.NXTCommFactory
Load a comms driver for a protocol (USB or Bluetooth)
CruizcoreGyro - Class in lejos.nxt.addon
This Class manages the Micro Infinity CruizcoreGyro.
CruizcoreGyro(I2CPort) - Constructor for class lejos.nxt.addon.CruizcoreGyro
Instantiates a new Cruizcore Gyro sensor.
CUSTOM - Static variable in class lejos.nxt.addon.OpticalDistanceSensor
Custom sensor
CUSTOM - Static variable in interface lejos.nxt.remote.NXTProtocol
 
CYAN - Static variable in class lejos.robotics.Color
 

D

D - Variable in class lejos.nxt.addon.RCXMotorMultiplexer
 
DARK_GRAY - Static variable in class lejos.robotics.Color
 
DATA_CONTAINS_OUT_OF_RANGE_VALUES - Static variable in interface lejos.nxt.remote.ErrorMessages
 
DCMotor - Interface in lejos.robotics
Interface for a regular DC motor.
decode(byte[]) - Static method in class lejos.nxt.remote.AsciizCodec
Convert an ASCIIZ byte array to a string
DEFAULT_I2C_ADDRESS - Static variable in class lejos.nxt.I2CSensor
 
DEFAULT_MMX_ADDRESS - Static variable in class lejos.nxt.addon.NXTMMX
 
DEFAULT_PFMATE_ADDRESS - Static variable in class lejos.nxt.addon.PFMate
 
DEFAULT_RCXMMUX_ADDRESS - Static variable in class lejos.nxt.addon.RCXMotorMultiplexer
 
DEFAULT_RCXSMUX_ADDRESS - Static variable in class lejos.nxt.addon.RCXSensorMultiplexer
 
defineAndRun(byte[], int) - Method in class lejos.nxt.addon.RCXLink
 
defineMacro(int, byte[]) - Method in class lejos.nxt.addon.RCXLink
 
defrag() - Method in class lejos.nxt.remote.NXTCommand
A NXJ extension to defrag the file system
DELAY - Static variable in class lejos.nxt.addon.RCXLink
 
Delay - Class in lejos.util
Simple collection of time delay routines that are non interruptable.
Delay() - Constructor for class lejos.util.Delay
 
delete(String) - Static method in class lejos.nxt.FileSystem
Delete a file from the NXT.
delete(String) - Method in class lejos.nxt.remote.NXTCommand
Delete a file on the NXT
DELETE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
DELETE_USER_FLASH - Static variable in interface lejos.nxt.remote.NXTProtocol
 
deleteFlashMemory() - Static method in class lejos.nxt.NXT
Deletes all user programs and data in FLASH memory
deleteUserFlash() - Method in class lejos.nxt.remote.NXTCommand
Deletes user flash memory.
DestinationUnreachableException - Exception in lejos.robotics.navigation
Exception thrown by path finders when the destination cannot be reached
DestinationUnreachableException() - Constructor for exception lejos.robotics.navigation.DestinationUnreachableException
 
det() - Method in class lejos.util.LUDecomposition
Determinant
deviceAddress - Variable in class lejos.pc.comm.NXTInfo
The device address.
deviceDiscovered(RemoteDevice, DeviceClass) - Method in class lejos.pc.comm.NXTCommBluecove
 
DeviceInfo - Class in lejos.nxt.remote
Represents a remote NXT accessed via LCP.
DeviceInfo() - Constructor for class lejos.nxt.remote.DeviceInfo
 
DGPS_CMD_ANGD - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_ANGR - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_DIST - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_HEAD - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_LAT - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_LONG - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_SLAT - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_SLONG - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_STATUS - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_UTC - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_CMD_VELO - Static variable in class lejos.nxt.addon.GPSSensor
 
DGPS_I2C_ADDR - Static variable in class lejos.nxt.addon.GPSSensor
 
DifferentialPilot - Class in lejos.robotics.navigation
The DifferentialPilot class is a software abstraction of the Pilot mechanism of a NXT robot.
DifferentialPilot(double, double, RegulatedMotor, RegulatedMotor) - Constructor for class lejos.robotics.navigation.DifferentialPilot
Allocates a DifferentialPilot object, and sets the physical parameters of the NXT robot.
Assumes Motor.forward() causes the robot to move forward.
DifferentialPilot(double, double, RegulatedMotor, RegulatedMotor, boolean) - Constructor for class lejos.robotics.navigation.DifferentialPilot
Allocates a DifferentialPilot object, and sets the physical parameters of the NXT robot.
DifferentialPilot(double, double, double, RegulatedMotor, RegulatedMotor, boolean) - Constructor for class lejos.robotics.navigation.DifferentialPilot
Allocates a DifferentialPilot object, and sets the physical parameters of the NXT robot.
DijkstraPathFinder - Class in lejos.robotics.pathfinding
This class calculates the shortest path from a starting point to a finish point.
DijkstraPathFinder(LineMap) - Constructor for class lejos.robotics.pathfinding.DijkstraPathFinder
 
DijkstraPathFinder.Node - Class in lejos.robotics.pathfinding
 
DijkstraPathFinder.Node(Point) - Constructor for class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
DijkstraPathFinder.Node(float, float) - Constructor for class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
DIRECT_COMMAND_NOREPLY - Static variable in interface lejos.nxt.remote.NXTProtocol
 
DIRECT_COMMAND_REPLY - Static variable in interface lejos.nxt.remote.NXTProtocol
 
DirectionFinder - Interface in lejos.robotics
Abstraction for compasses and other devices than return the heading of a robot.
dis - Variable in class lejos.pc.comm.RemoteFrame
 
disconnect(Node, Node) - Method in class lejos.robotics.pathfinding.FourWayGridMesh
 
disconnect(Node, Node) - Method in interface lejos.robotics.pathfinding.NavigationMesh
Disconnects two nodes by removing them as neighbors.
distanceTo(float, float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Returns the distance from robot current location to the point with coordinates x,y
distanceTo(Point) - Method in class lejos.robotics.navigation.Pose
Return the distance to the destination
distBetweenPoints(Point, Point) - Static method in class lejos.robotics.navigation.ArcAlgorithms
Calculates the distance between any two points.
dos - Variable in class lejos.pc.comm.RemoteFrame
 
dotProduct(Point) - Method in class lejos.geom.Point
 
download(String) - Static method in class lejos.nxt.FileSystem
 
download(String, File) - Static method in class lejos.nxt.FileSystem
Download a file from the NXT and save it to a file.
download(String, String) - Static method in class lejos.nxt.FileSystem
Download a file from the NXT and save it to a local directory.
dumpClosest(RangeReadings, RangeMap, DataOutputStream, float, float) - Method in class lejos.robotics.localization.MCLParticleSet
Find the closest particle to specified coordinates and dump its details to a data output stream.
dumpEstimation(DataOutputStream) - Method in class lejos.robotics.localization.MCLPoseProvider
Dump the serialized estimate of pose to a data output stream
dumpMap(DataOutputStream) - Method in class lejos.robotics.mapping.LineMap
Dump the map to a DataOutputStream
dumpParticles(DataOutputStream) - Method in class lejos.robotics.localization.MCLParticleSet
Serialize the particle set to a data output stream
dumpReadings(DataOutputStream) - Method in class lejos.robotics.RangeReadings
Dump the readings to a DataOutputStream

E

EEPROM_BUFFER - Static variable in class lejos.nxt.addon.RCXLink
 
elapsed() - Method in class lejos.util.Stopwatch
Return elapsed time in milliseconds
enableColorSensor() - Method in class lejos.nxt.SensorPort
 
enableDetection(boolean) - Method in interface lejos.robotics.objectdetection.FeatureDetector
Enable or disable detection of objects.
enableDetection(boolean) - Method in class lejos.robotics.objectdetection.FeatureDetectorAdapter
 
enableDetection(boolean) - Method in class lejos.robotics.objectdetection.FusorDetector
This method enables/disables automatic scanning and listener reporting for this object and all FeatureDetectors used in this FusorDetector object.
enableTracking(boolean) - Method in class lejos.nxt.addon.NXTCam
 
encode(String) - Static method in class lejos.nxt.remote.AsciizCodec
Encode a string as ASCIIZ
Encoder - Interface in lejos.robotics
Abstraction for the tachometer built into NXT motors.
EncoderMotor - Interface in lejos.robotics
An EncoderMotor is a platform independent interface for an unregulated motor that also has basic tachometer functions.
END_OF_FILE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
END_OF_FILE_EXPECTED - Static variable in interface lejos.nxt.remote.ErrorMessages
 
EOPD - Class in lejos.nxt.addon
Supports HiTechnics EOPD (Electro Optical Proximity Detector) sensor.
This sensor is used to detect objects and small changes in distance to a target.
EOPD(ADSensorPort) - Constructor for class lejos.nxt.addon.EOPD
By default the sensor is short range.
EOPD(ADSensorPort, boolean) - Constructor for class lejos.nxt.addon.EOPD
 
err - Static variable in class lejos.pc.comm.SystemContext
Deprecated.  
error(String) - Method in class lejos.pc.comm.RemoteFrame
Print the error message and exit
ErrorMessages - Interface in lejos.nxt.remote
Error messages that can be returned after a call to the NXT brick.
exit(int) - Static method in class lejos.nxt.NXT
Close the connection to the NXT and exit
extend(int, boolean) - Method in class lejos.nxt.addon.LinearActuator
Causes the actuator to extend distance in encoder ticks.

F

FAHRENHEITMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
Feature - Interface in lejos.robotics.objectdetection
A Feature is an interface for information retrieved about an object detected by sensors.
featureDetected(Feature, FeatureDetector) - Method in interface lejos.robotics.objectdetection.FeatureListener
The angle and range (in a RangeReading) of a feature is reported when a feature is detected.
featureDetected(Feature, FeatureDetector) - Method in class lejos.robotics.objectdetection.FusorDetector
This method must deal with different delays from different sensors.
FeatureDetector - Interface in lejos.robotics.objectdetection
A FeatureDetector is capable of detecting objects and notifying listeners when it detects something.
FeatureDetectorAdapter - Class in lejos.robotics.objectdetection
An adapter to make it easier to implement FeatureDetector classes.
FeatureDetectorAdapter(int) - Constructor for class lejos.robotics.objectdetection.FeatureDetectorAdapter
 
FeatureListener - Interface in lejos.robotics.objectdetection
Any class implementing this interface and registering with a FeatureDetector will receive notifications when a feature is detected.
fetchString(byte, int) - Method in class lejos.nxt.addon.RFIDSensor
We over-ride the default implementation to ensure that the device is awake before we talk to it.
fetchString(byte, int) - Method in class lejos.nxt.I2CSensor
Read a string from the device.
FILE_EXISTS - Static variable in interface lejos.nxt.remote.ErrorMessages
 
FILE_IS_BUSY - Static variable in interface lejos.nxt.remote.ErrorMessages
 
FILE_IS_FULL - Static variable in interface lejos.nxt.remote.ErrorMessages
 
FILE_NOT_FOUND - Static variable in interface lejos.nxt.remote.ErrorMessages
 
fileHandle - Variable in class lejos.nxt.remote.FileInfo
The handle for accessing the file.
FileInfo - Class in lejos.nxt.remote
Structure that gives information about a leJOS NXJ file.
FileInfo(String) - Constructor for class lejos.nxt.remote.FileInfo
 
fileName - Variable in class lejos.nxt.remote.FileInfo
The name of the file - up to 20 characters.
fileSize - Variable in class lejos.nxt.remote.FileInfo
The size of the file in bytes.
FileSystem - Class in lejos.nxt
Support for remote file operations
FIND_FIRST - Static variable in interface lejos.nxt.remote.NXTProtocol
 
FIND_NEXT - Static variable in interface lejos.nxt.remote.NXTProtocol
 
findCircleCenter(Point, float, float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
Calculates the center of a circle that rests on the tangent of the vehicle's starting heading.
findClosest(float, float) - Method in class lejos.robotics.localization.MCLParticleSet
Find the index of the particle closest to a given co-ordinates.
findFirst(String) - Method in class lejos.nxt.remote.NXTCommand
Find the first file on the NXT.
findFirstNXJ(String) - Method in class lejos.nxt.remote.NXTCommand
Find the first file on the NXT.
findNext(byte) - Method in class lejos.nxt.remote.NXTCommand
Find the next file on the NXT
findNextNXJ(byte) - Method in class lejos.nxt.remote.NXTCommand
Find the next file on the NXT.
findP2(Point, Point, float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
This method finds P2 if the vehicle is traveling to a point (with no heading).
findPath(Node, Node) - Method in class lejos.robotics.pathfinding.AstarSearchAlgorithm
 
findPath(Node, Node) - Method in interface lejos.robotics.pathfinding.SearchAlgorithm
Method accepts a start node and a goal node, and returns a path consisting of a collection of waypoints which includes the startNode coordinates as the first waypoint, and the goal node coordinates as the final waypoint.
findPointOnHeading(Point, float, float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
Given a starting point and heading, this method will calculate another Point that is distance away from the first point.
findRoute(Pose, WayPoint) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
Finds the shortest path from start to finish using the map (or collection of lines) in the constructor.
findRoute(Pose, WayPoint, LineMap) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
Finds the shortest path from start to finish using the map (or collection of lines) in the constructor.
findRoute(Pose, WayPoint) - Method in class lejos.robotics.pathfinding.NodePathFinder
 
findRoute(Pose, WayPoint) - Method in interface lejos.robotics.pathfinding.PathFinder
 
findRoute(Pose, WayPoint) - Method in class lejos.robotics.pathfinding.RandomPathFinder
 
findRoute(Pose, WayPoint) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
Finds the shortest path from start to finish using the map (or collection of lines) in the constructor.
findRoute(Pose, WayPoint, LineMap) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
Finds the shortest path from start to finish using the map (or collection of lines) in the constructor.
FirmwareInfo - Class in lejos.nxt.remote
Firmware information for a remote NXT accessed via LCP.
FirmwareInfo() - Constructor for class lejos.nxt.remote.FirmwareInfo
 
firmwareVersion - Variable in class lejos.nxt.remote.FirmwareInfo
 
FixedRangeScanner - Class in lejos.robotics
 
FixedRangeScanner(RotateMoveController, RangeFinder) - Constructor for class lejos.robotics.FixedRangeScanner
 
FLASH_BASE - Static variable in class lejos.pc.comm.NXTSamba
The NXT has 256KB Flash starting at 0x100000, divided into 256byte pages.
FLASH_MAX - Static variable in class lejos.pc.comm.NXTSamba
 
FLASH_SIZE - Static variable in class lejos.pc.comm.NXTSamba
 
FLOAT - Static variable in interface lejos.nxt.BasicMotorPort
Motor is floating (no PWM drive)
fLogListeners - Variable in class lejos.pc.comm.NXTCommLoggable
 
flt(boolean) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Causes motor to float.
flt() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Causes motor to float.
flt() - Method in class lejos.nxt.addon.NXTMMXMotor
Causes motor to float.
flt() - Method in class lejos.nxt.addon.PFMateMotor
Floats the motor
flt() - Method in class lejos.nxt.BasicMotor
Causes motor to float.
flt(boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
flt() - Method in class lejos.nxt.remote.RemoteMotor
 
flt() - Method in interface lejos.robotics.BaseMotor
Motor loses all power, causing the rotor to float freely to a stop.
flt(boolean) - Method in interface lejos.robotics.RegulatedMotor
Set the motor into float mode.
fltMotor(int) - Method in class lejos.nxt.addon.RCXLink
 
fltMotors() - Method in class lejos.nxt.addon.NXTMMX
Floats both motors
flush() - Method in class lejos.nxt.addon.RCXLink
 
flush() - Method in class lejos.pc.comm.NXTCommOutputStream
 
flushQueue() - Method in class lejos.robotics.navigation.NavPathController
 
flushQueue() - Method in interface lejos.robotics.navigation.PathController
Stops the robot and empties the queue of waypoints (the route)
followRoute(Collection<WayPoint>, boolean) - Method in class lejos.robotics.navigation.NavPathController
 
followRoute(Collection<WayPoint>, boolean) - Method in interface lejos.robotics.navigation.PathController
Moves the robot through the sequence of waypoints contained in the route.
forward() - Method in class lejos.nxt.addon.LServo
Classic forward method for continous RC Servos
forward() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Causes motor to rotate forward.
forward() - Method in class lejos.nxt.addon.NXTMMXMotor
Causes motor to rotate forward.
forward() - Method in class lejos.nxt.addon.PFMateMotor
Runs the motor forward
forward(int) - Method in class lejos.nxt.addon.RCXLink
 
forward() - Method in class lejos.nxt.BasicMotor
Causes motor to rotate forward.
FORWARD - Static variable in interface lejos.nxt.BasicMotorPort
Motor is running forward
forward() - Method in class lejos.nxt.remote.RemoteMotor
 
forward() - Method in interface lejos.robotics.BaseMotor
Causes motor to rotate forward until stop() or flt() is called.
forward() - Method in class lejos.robotics.navigation.DifferentialPilot
Starts the NXT robot moving forward.
forward() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
forward() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
forward() - Method in interface lejos.robotics.navigation.MoveController
Starts the NXT robot moving forward.
forward() - Method in class lejos.robotics.navigation.SteeringPilot
 
forwardStep(int) - Method in class lejos.nxt.addon.IRLink
 
forwardStep(int) - Method in interface lejos.nxt.addon.IRTransmitter
 
forwardStep(int) - Method in class lejos.nxt.addon.RCXLink
 
FourWayGridMesh - Class in lejos.robotics.pathfinding
Generates a grid of nodes.
FourWayGridMesh(LineMap, float, float) - Constructor for class lejos.robotics.pathfinding.FourWayGridMesh
Instantiates a grid mesh of nodes which won't interconnect between any map geometry.
freeFlash - Variable in class lejos.nxt.remote.DeviceInfo
 
FusorDetector - Class in lejos.robotics.objectdetection
If you have a robot with multiple sensors (touch and range) and would like them to report to one listener, or if you want to control them at the same time (such as disabling them all at once) you can use this class.
FusorDetector() - Constructor for class lejos.robotics.objectdetection.FusorDetector
 

G

generateParticles() - Method in class lejos.robotics.localization.MCLPoseProvider
Generate a new particle set, uniformly distributed within the map, and uniformly distributed heading.
get(int, int) - Method in class lejos.util.Matrix
Get a single element.
GET_BATTERY_LEVEL - Static variable in interface lejos.nxt.remote.NXTProtocol
 
GET_CURRENT_PROGRAM_NAME - Static variable in interface lejos.nxt.remote.NXTProtocol
 
GET_DEVICE_INFO - Static variable in interface lejos.nxt.remote.NXTProtocol
 
GET_FIRMWARE_VERSION - Static variable in interface lejos.nxt.remote.NXTProtocol
 
GET_INPUT_VALUES - Static variable in interface lejos.nxt.remote.NXTProtocol
 
GET_OUTPUT_STATE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
getAccAngle() - Method in class lejos.nxt.addon.AngleSensor
reads the current accumulated angle
getAccel() - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the accel.
getAccel(int) - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the acceleration in the specified axis.
getAccumulatedAngle() - Method in class lejos.nxt.addon.AngleSensor
 
getActualMode() - Method in class lejos.nxt.UltrasonicSensor
Returns the current operating mode of the sensor.
getAMPM() - Method in interface lejos.robotics.Clock
 
getAngle() - Method in class lejos.nxt.addon.AngleSensor
reads the current angle
getAngle() - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the accumulated angle (heading).
getAngle(boolean) - Method in class lejos.nxt.addon.IRSeekerV2
Returns the angle of the target (-180 to 180) or NaN.
getAngle() - Method in class lejos.nxt.addon.IRSeekerV2
 
getAngle() - Method in class lejos.nxt.addon.LServo
Method to know the angle
getAngle() - Method in class lejos.nxt.addon.MServo
Return the angle used in last operation
getAngle() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. gets the current robot pose
getAngle() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
getAngle() - Method in class lejos.robotics.RangeReading
Get the angle of the range reading
getAngle(int) - Method in class lejos.robotics.RangeReadings
Get the angle of a specific reading
getAngleIncrement() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Returns the change in robot heading since the last call of reset() normalized to be within -180 and _180 degrees
getAngleIncrement() - Method in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this method will be private in NXJ version 1.0 when the CompassPilot is removed and ArcNavigator sample will need to be updated to not use these methods.
getAngleToDest() - Method in class lejos.nxt.addon.GPSSensor
Angle to destination in degrees
getAngleTurned() - Method in class lejos.robotics.navigation.Move
Get the angle turned by a rotate or an arc operation.
getAngularAcceleration() - Method in class lejos.nxt.addon.GyroDirectionFinder
Returns the current rate at which the angular velocity is increasing or decreasing in degrees-per-second, per second.
getAngularVelocity() - Method in class lejos.nxt.addon.GyroDirectionFinder
Returns the current rate-of-turn in degrees/second, as read by the GyroSensor instance passed in the constructor.
getAngularVelocity() - Method in class lejos.nxt.addon.GyroSensor
Calculate and return the current angular velocity.
getAngularVelocity() - Method in interface lejos.robotics.Gyroscope
Implementor must calculate and return the angular velocity in degrees per second.
getArc(Point, Point, float, float, boolean) - Static method in class lejos.robotics.navigation.ArcAlgorithms
If p1 is the starting point of the robot, and p2 is the point at which the robot is pointing directly at the target point, this method calculates the angle to travel along the circle (an arc) to get from p1 to p2.
getArcBackward(float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
Quick calculation of reverse arc instead of going through getArcLength() math again.
getArch() - Method in class lejos.util.jni.OSInfo
Get the name of the architecture.
getArcOld(Point, Point, double) - Static method in class lejos.robotics.navigation.ArcAlgorithms
Deprecated. This method is no longer used because it can't calculate >180 angles. Delete any time.
getArcRadius() - Method in class lejos.robotics.navigation.Move
Get the radius of the arc
getArray() - Method in class lejos.util.Matrix
Access the internal two-dimensional array.
getArrayCopy() - Method in class lejos.util.Matrix
Copy the internal two-dimensional array.
getAvailablePaths(Pose, float, Pose, float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
This method gets all the available paths given a start Pose and destination Post.
getAvailablePaths(Pose, Point, float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
This method calculates the moves needed to drive from a starting Pose to a final Point.
getAverage(int) - Method in class lejos.nxt.addon.IRSeekerV2
Returns the average sensor reading (DC Only)
getAverage() - Method in class lejos.nxt.addon.NXTLineLeader
Get the average value
getBackground() - Method in class lejos.nxt.ColorSensor.Color
Return the background light level reading
getBattery() - Method in class lejos.nxt.addon.MSC
Read the battery voltage data from NXTServo module (in millivolts)
getBatteryLevel() - Method in class lejos.nxt.remote.NXTCommand
Get the battery reading
getBest(DijkstraPathFinder.Node) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
Helper method for findPath()
returns the node in the Reached set, whose distance from the start node plus its straight line distance to the destination is the minimum.
getBest(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
Helper method for findPath()
returns the node in the Reached set, whose distance from the start node plus its straight line distance to the destination is the minimum.
getBestPath(Pose, float, Pose, float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
Find the shortest path for a steering vehicle between two points.
getBestPath(Pose, Point, float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
This method generates the shortest path from a starting Pose to a final Point.
getBestPath(Move[][]) - Static method in class lejos.robotics.navigation.ArcAlgorithms
This helper method accepts a number of paths (an array of Move) and selects the shortest path.
getBlockTacho() - Method in class lejos.nxt.remote.RemoteMotor
Deprecated.  
getBlue() - Method in class lejos.robotics.Color
Returns the blue component in the range 0-255 in the default sRGB space.
getBorder() - Method in class lejos.robotics.localization.MCLParticleSet
Get the border where particles should not be generated
getBoundingRect() - Method in class lejos.robotics.mapping.LineMap
Return the bounding rectangle of the mapped area
getBoundingRect() - Method in interface lejos.robotics.mapping.RangeMap
Get the bounding rectangle for the mapped area
getBrickName() - Static method in class lejos.nxt.NXT
Get the friendly name of the brick
getButtons() - Method in class lejos.nxt.addon.PSPNXController
Each bit in the short byte represents the boolean (pressed or not pressed) of a button.
getByte(int) - Method in interface lejos.robotics.Clock
 
getCalibratedSensorReading(int) - Method in class lejos.nxt.addon.NXTLineLeader
Get the calibrated reading of a given sensor
getCalibrationData(int, NXTLineLeader.LineColor) - Method in class lejos.nxt.addon.NXTLineLeader
Get the calibration data for white and black colors for a given sensor
getCalibrationData(byte[]) - Method in class lejos.nxt.UltrasonicSensor
Return 3 bytes of calibration data.
getCelcius() - Method in class lejos.nxt.addon.RCXTemperatureSensor
Convert sensor value to Celcius, value outside [-20;70] is not accurate
getChannel() - Method in class lejos.nxt.addon.PFMate
Returns the current IR channel in use by the PF Mate
getColor() - Method in class lejos.nxt.addon.ColorSensorHT
 
getColor() - Method in class lejos.nxt.ColorSensor
Return a Color Object that contains the calibrated color readings.
getColor() - Method in class lejos.robotics.Color
 
getColor() - Method in interface lejos.robotics.ColorDetector
Return the Red, Green and Blue values together in one object.
getColorID() - Method in class lejos.nxt.addon.ColorSensorHT
Returns the color index detected by the sensor.
getColorID() - Method in class lejos.nxt.ColorSensor
Read the current color and return an enumeration constant.
getColorID() - Method in interface lejos.robotics.ColorDetector
Return an enumerated constant that indicates the color detected.
getColorIndexNumber() - Method in class lejos.nxt.addon.ColorSensorHT
Essentially the same as getColorNumber() but with a resolution of 6 bits.
getColumnDimension() - Method in class lejos.util.Matrix
Get column dimension.
getColumnPackedCopy() - Method in class lejos.util.Matrix
Make a one-dimensional column packed copy of the internal array.
getCompass() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Return the compass
getCompassHeading() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Method returns the current compass heading
getContinuousInterval() - Method in class lejos.nxt.UltrasonicSensor
Return the interval used in continuous mode.
getCovariance() - Method in class lejos.util.KalmanFilter
 
getCurrentProgramName() - Static method in class lejos.nxt.FileSystem
Retrieves the file name of the Lego executable currently running on the NXT.
getCurrentProgramName() - Method in class lejos.nxt.remote.NXTCommand
Name of current running program.
getCurveCount() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets the number of points that will be in the curve.
getData(int, byte[], int) - Method in class lejos.nxt.I2CSensor
 
getData(int, byte[], int, int) - Method in class lejos.nxt.I2CSensor
Method for retrieving data values from the sensor.
getData(int) - Method in class lejos.nxt.I2CSensor
Helper method to return a single register byte.
getData(int, byte[], int, int) - Method in class lejos.nxt.UltrasonicSensor
 
getDataIn() - Method in class lejos.pc.comm.NXTConnector
 
getDataOut() - Method in class lejos.pc.comm.NXTConnector
 
getDateString() - Method in interface lejos.robotics.Clock
 
getDay() - Method in interface lejos.robotics.Clock
 
getDayOfWeek() - Method in interface lejos.robotics.Clock
 
getDCMotor(int) - Method in class lejos.nxt.addon.LSC
Method to get an LDC Motor
getDegrees() - Method in class lejos.nxt.addon.CompassSensor
Returns the directional heading in degrees.
getDegrees() - Method in class lejos.nxt.addon.GyroDirectionFinder
Returns the directional heading in degrees.
getDegreesCartesian() - Method in class lejos.nxt.addon.CompassSensor
Compass readings increase clockwise from 0 to 360, but Cartesian coordinate systems increase counter-clockwise.
getDegreesCartesian() - Method in class lejos.nxt.addon.GyroDirectionFinder
Returns the current rate-of-turn in degrees, as read by the GyroSensor.
getDegreesCartesian() - Method in interface lejos.robotics.DirectionFinder
Compass readings increase clockwise from 0 to 360, but Cartesian coordinate systems increase counter-clockwise.
getDelay() - Method in interface lejos.robotics.objectdetection.FeatureDetector
The minimum delay between notification of readings from the feature detector.
getDelay() - Method in class lejos.robotics.objectdetection.FeatureDetectorAdapter
 
getDelay() - Method in class lejos.robotics.objectdetection.FusorDetector
 
getDeviceInfo() - Method in class lejos.nxt.remote.NXTCommand
Gets device information
getDirection() - Method in class lejos.nxt.addon.IRSeeker
Returns the direction of the target (1-9) or zero if no target.
getDirection() - Method in class lejos.nxt.addon.IRSeekerV2
Returns the direction of the target (1 to 9) or 0 if no target.
getDirection(int) - Method in class lejos.nxt.addon.RCXMotorMultiplexer
 
getDistance() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Returns the distance from the object in millimeters.
getDistance(int) - Method in class lejos.nxt.addon.SensorMux
Method used to use a US with the sensor and get the distances
getDistance() - Method in class lejos.nxt.UltrasonicSensor
Return distance to an object.
getDistance(Point) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
get the straight line distance from this node to aPoint
getDistance(DijkstraPathFinder.Node) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
return the straight distance from this node to aNode
getDistance(Point) - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
get the straight line distance from this node to aPoint
getDistance(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
return the straight distance from this node to aNode
getDistances(int[]) - Method in class lejos.nxt.UltrasonicSensor
Return an array of distances.
getDistances(int[], int, int) - Method in class lejos.nxt.UltrasonicSensor
Return an array of distances.
getDistanceToDest() - Method in class lejos.nxt.addon.GPSSensor
Distance to destination in meters
getDistanceTraveled() - Method in class lejos.robotics.navigation.Move
Get the distance traveled.
getDistLSB() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Returns the current distance in millimeters for the LSB.
getDistMaxLSB() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets the max value in millimeters for the LSB.
Used for recalibrating the sensor.
getDistMaxMSB() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets the max value in millimeters for the MSB.
Used for recalibrating the sensor.
getDistMinLSB() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets the min value in millimeters for the LSB.
Used for recalibrating the sensor.
getDistMinMSB() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets the min value in millimeters for the MSB.
Used for recalibrating the sensor.
getDistMSB() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Returns the current distance in millimeters for MSB.
getDistPointLSB(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets millimeter value of the specific index for the LSB.
Used for recalibrating the sensor.
getDistPointMSB(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets millimeter value of the specific index for the MSB.
getDoublePivot() - Method in class lejos.util.LUDecomposition
Return pivot permutation vector as a one-dimensional double array
getError() - Method in class lejos.nxt.rcxcomm.PacketHandler
Get the last error.
getErrorRect() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the minimum rectangle enclosing all the particles
getF_Score() - Method in class lejos.robotics.pathfinding.Node
Method used by A* to calculate search score.
getFactoryData(byte[]) - Method in class lejos.nxt.UltrasonicSensor
Return 10 bytes of factory calibration data.
getFahrenheit() - Method in class lejos.nxt.addon.RCXTemperatureSensor
Convert sensor value to Fahrenheit, value outside [-4;158] is not accurate
getFileNames() - Static method in class lejos.nxt.FileSystem
Returns a list of all files on NXT brick.
getFileNames(String) - Static method in class lejos.nxt.FileSystem
Returns a list of files on NXT brick.
getFirmwareVersion() - Method in class lejos.nxt.addon.NXTCam
Returns the NXTCam firmware version.
getFirmwareVersion() - Static method in class lejos.nxt.NXT
Get the (emulated) standard LEGO firmware version number
getFirmwareVersion() - Method in class lejos.nxt.remote.NXTCommand
Get the fimrware version.
getFlashMemory() - Static method in class lejos.nxt.NXT
Get the number of bytes of free flash memory
getFloodlight() - Method in class lejos.nxt.addon.RCXLightSensor
 
getFloodlight() - Method in class lejos.nxt.ColorSensor
 
getFloodlight() - Method in class lejos.nxt.LightSensor
 
getFloodlight() - Method in interface lejos.robotics.LampLightDetector
Returns the color of the floodlight, including Color.NONE.
getFriendlyName() - Method in class lejos.nxt.remote.NXTCommand
Get the friendly name of the NXT
getG_Score() - Method in class lejos.robotics.pathfinding.Node
<<<<<<< .mine Method used by A* to calculate search score.
getGain() - Method in class lejos.util.KalmanFilter
 
getGreen() - Method in class lejos.robotics.Color
Returns the green component in the range 0-255 in the default sRGB space.
getHeading() - Method in class lejos.nxt.addon.GPSSensor
Read the current heading in degrees
getHeading(float, float) - Static method in class lejos.robotics.navigation.ArcAlgorithms
Given the former heading and the change in heading, this method will calculate a new heading.
getHeading(Point, Point) - Static method in class lejos.robotics.navigation.ArcAlgorithms
Calculates the heading designated by two points.
getHeading() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Returns direction of desired robot facing
getHeading() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. gets the current value of the robot heading
getHeading() - Method in class lejos.robotics.navigation.Pose
returns the heading (direction angle) of the Pose
getHeading() - Method in class lejos.robotics.navigation.WayPoint
 
getHeadingError() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Determines the difference between actual compass direction and desired heading in degrees
getHigh() - Method in class lejos.nxt.addon.RCXLightSensor
 
getHigh() - Method in class lejos.nxt.ColorSensor
return the normalized value corresponding to readValue() = 100;
getHigh() - Method in class lejos.nxt.LightSensor
return the normalized value corresponding to readValue() = 100%
getHigh() - Method in interface lejos.robotics.LightDetector
The highest raw light value this sensor can return from intense bright light.
getHour() - Method in interface lejos.robotics.Clock
 
getId() - Method in interface lejos.nxt.I2CPort
 
getId() - Method in class lejos.nxt.I2CSensor
 
getId() - Method in class lejos.nxt.remote.RemoteMotor
Get the ID of the motor.
getId() - Method in class lejos.nxt.SensorPort
 
getInputStream() - Method in class lejos.nxt.rcxcomm.RCXAbstractPort
Returns an input stream for this RCXPort.
getInputStream() - Method in interface lejos.pc.comm.NXTComm
Return an InputStream for reading a stream of data from the NXT over this connection.
getInputStream() - Method in class lejos.pc.comm.NXTCommBluecove
 
getInputStream() - Method in class lejos.pc.comm.NXTCommBluez
 
getInputStream() - Method in class lejos.pc.comm.NXTCommUSB
 
getInputStream() - Method in class lejos.pc.comm.NXTConnector
 
getInputValues(int) - Method in class lejos.nxt.remote.NXTCommand
Get input values for a specific NXT sensor port
getInstance(int) - Method in class lejos.nxt.addon.TouchMUX
Return a Touch interface providing access to the sensor specified by the given id.
getIterationCount() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
 
getIterationCount() - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
getIterations() - Method in class lejos.robotics.localization.MCLParticleSet
 
getKD() - Method in class lejos.nxt.addon.NXTLineLeader
Get KD value
getKDDivisor() - Method in class lejos.nxt.addon.NXTLineLeader
Get KD divisor
getKI() - Method in class lejos.nxt.addon.NXTLineLeader
Get KI value
getKIDivisor() - Method in class lejos.nxt.addon.NXTLineLeader
Get KI divisor
getKP() - Method in class lejos.nxt.addon.NXTLineLeader
Get KP value
getKPDivisor() - Method in class lejos.nxt.addon.NXTLineLeader
Get KP divisor
getL() - Method in class lejos.util.LUDecomposition
Return lower triangular factor
getLastAccel() - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the last acceleration read from the 3 axes.
getLastAccel(int) - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the last accel.
getLastAngle() - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the last angle.
getLastPitch() - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the last pitch.
getLastRate() - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the last rate.
getLastRoll() - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the last roll.
getLat() - Method in class lejos.nxt.addon.GPSSensor
Read the current latitude in degrees (positive=North, negative=South)
getLeft() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. Returns the left motor.
getLeftCount() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. Returns the tachoCount of the left motor
getLeftX() - Method in class lejos.nxt.addon.PSPNXController
 
getLeftY() - Method in class lejos.nxt.addon.PSPNXController
 
getLightValue() - Method in class lejos.nxt.addon.RCXLightSensor
 
getLightValue() - Method in class lejos.nxt.ColorSensor
Return the calibrated light reading.
getLightValue() - Method in class lejos.nxt.LightSensor
 
getLightValue() - Method in interface lejos.robotics.LightDetector
Returns the calibrated and normalized brightness of the white light detected.
getLimitAngle() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Return the absolute angle that this Motor is rotating to.
getLimitAngle() - Method in class lejos.nxt.addon.NXTMMXMotor
Return the angle that a Motor is rotating to.
getLimitAngle() - Method in class lejos.nxt.remote.RemoteMotor
RegulatedMotor for NXT need this
getLimitAngle() - Method in interface lejos.robotics.RegulatedMotor
Return the limit angle (if any)
getLines() - Method in class lejos.robotics.mapping.LineMap
 
getLink() - Static method in class lejos.nxt.rcxcomm.LLC
Return the RCXLink object associated with LLC
getLink() - Static method in class lejos.nxt.rcxcomm.Serial
Get the RCXLink object associated with the Serial class
getLocalAddress() - Method in class lejos.nxt.remote.NXTCommand
Get the local address of the NXT.
getLocation() - Method in class lejos.robotics.navigation.Pose
Get the location as a Point
getLocation() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
return the location of this node
getLocation() - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
return the location of this node
getLong() - Method in class lejos.nxt.addon.GPSSensor
Read the current longitude in degrees (positive=East, negative=West)
getLow() - Method in class lejos.nxt.addon.RCXLightSensor
 
getLow() - Method in class lejos.nxt.ColorSensor
return the normalized value corresponding to readValue() = 0
getLow() - Method in class lejos.nxt.LightSensor
return the normalized value corresponding to readValue() = 0%
getLow() - Method in interface lejos.robotics.LightDetector
The lowest raw light value this sensor can return in pitch black darkness.
getLSC(int) - Method in class lejos.nxt.addon.NXTe
Get a LSC, Lattebox Servo Controller
getMap() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
 
getMap() - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
getMatrix(int, int, int, int) - Method in class lejos.util.Matrix
Get a submatrix.
getMatrix(int[], int[]) - Method in class lejos.util.Matrix
Get a submatrix.
getMatrix(int, int, int[]) - Method in class lejos.util.Matrix
Get a submatrix.
getMatrix(int[], int, int) - Method in class lejos.util.Matrix
Get a submatrix.
getMaxDistance() - Method in class lejos.robotics.objectdetection.RangeFeatureDetector
Returns the maximum distance the FeatureDetector will return for detected objects.
getMaxHeadingError() - Method in class lejos.robotics.navigation.WayPoint
 
getMaxPositionError() - Method in class lejos.robotics.navigation.WayPoint
 
getMaxRotateSpeed() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getMaxRotateSpeed() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
getMaxSpeed() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Return the maximum speed of the motor.
getMaxSpeed() - Method in class lejos.nxt.remote.RemoteMotor
 
getMaxSpeed() - Method in interface lejos.robotics.RegulatedMotor
Returns the maximim speed of the motor.
getMaxTravelSpeed() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getMaxTravelSpeed() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
getMaxTravelSpeed() - Method in interface lejos.robotics.navigation.MoveController
Returns the maximum speed at which this robot is capable of traveling forward and backward.
getMaxTravelSpeed() - Method in class lejos.robotics.navigation.SteeringPilot
 
getMaxWeight() - Method in class lejos.robotics.localization.MCLParticleSet
The highest weight of any particle
getMaxX() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the maximum value of X in the particle set
getMaxY() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the maximum value of Y in the particle set;
getMean() - Method in class lejos.util.KalmanFilter
 
getMesh() - Method in class lejos.robotics.pathfinding.FourWayGridMesh
 
getMesh() - Method in interface lejos.robotics.pathfinding.NavigationMesh
Returns a collection of all nodes within this navigation mesh.
getMessage() - Method in exception lejos.pc.comm.NXTCommException
 
getMinRadius() - Method in interface lejos.robotics.navigation.ArcMoveController
The minimum steering radius this vehicle is capable of when traveling in an arc.
getMinRadius() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getMinRadius() - Method in class lejos.robotics.navigation.SteeringPilot
In practice, a robot might steer tighter with one turn than the other.
getMinute() - Method in interface lejos.robotics.Clock
 
getMinX() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the minimum value of X in the particle set;
getMinY() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the minimum value of Y in the particle set;
getMode() - Method in class lejos.nxt.addon.ColorSensorHT
Returns the value of the mode control register (0x41)
getMode() - Method in class lejos.nxt.addon.NXTMMXMotor
Returns the mode
getMode() - Method in class lejos.nxt.addon.PSPNXController
Returns the current operating mode of the sensor.
getMode() - Method in interface lejos.nxt.BasicSensorPort
 
getMode() - Method in class lejos.nxt.SensorPort
 
getMode() - Method in class lejos.nxt.UltrasonicSensor
Returns the current operating mode of the sensor.
getMonth() - Method in interface lejos.robotics.Clock
 
getMotor() - Method in class lejos.nxt.addon.PFMate
Returns which motors are activated
getMotor(String) - Static method in class lejos.util.PilotProps
Utility method to get Motor instance from string (A, B or C)
getMoveController() - Method in class lejos.robotics.navigation.NavPathController
Returns a reference to the MoveController.
getMoveController() - Method in interface lejos.robotics.navigation.PathController
Note: There is no corresponding setMoveController() method because the type of robot vehicle could not change after the program starts, unless it was physically a transformer robot.
getMoveMaxSpeed() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. 
getMovement() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getMovement() - Method in interface lejos.robotics.navigation.MoveProvider
Returns the move made since the move started, but before it has completed.
getMovement() - Method in class lejos.robotics.navigation.SteeringPilot
 
getMovementIncrement() - Method in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this method will be private in NXJ version 1.0 when the CompassPilot is removed and ArcNavigator sample will need to be updated to not use these methods.
getMovementIncrement() - Method in class lejos.robotics.navigation.SteeringPilot
 
getMoveSpeed() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. 
getMoveType() - Method in class lejos.robotics.navigation.Move
Get the type of the movement performed
getName() - Method in class lejos.nxt.addon.LMotor
Get name from a RC Servo or a DC Motor
getNeighbors() - Method in class lejos.robotics.pathfinding.Node
Returns all the neighbors which this node is connected to.
getNeighbors() - Method in class lejos.robotics.pathfinding.RandomSelfGeneratingNode
When this method is called the first time, it randomly generates a set of neighbors according to the parameters in the constructor.
getNodeCount() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
 
getNodeCount() - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
getNormalized() - Method in class lejos.geom.Point
 
getNormalizedLightValue() - Method in class lejos.nxt.addon.RCXLightSensor
 
getNormalizedLightValue() - Method in class lejos.nxt.ColorSensor
Return the normalized light level.
getNormalizedLightValue() - Method in class lejos.nxt.LightSensor
Get the normalized light reading
getNormalizedLightValue() - Method in interface lejos.robotics.LightDetector
Returns the normalized value of the brightness of the white light detected, such that the lowest value is darkness and the highest value is intense bright light.
getNumberOfObjects() - Method in class lejos.nxt.addon.NXTCam
Get the number of objects being tracked
getNumReadings() - Method in class lejos.robotics.RangeReadings
Get the number of readings in a set
getNXJCache() - Static method in class lejos.pc.comm.NXTCommFactory
Load the Bluetooth name cache as properties
getNxjHome() - Static method in class lejos.pc.comm.SystemContext
Deprecated.  
getNXJProperties() - Static method in class lejos.pc.comm.NXTCommFactory
Load the leJOS NXJ properties
getNXTComm() - Method in class lejos.pc.comm.NXTConnector
 
getNXTInfo() - Method in class lejos.pc.comm.NXTConnector
 
getNXTInfos() - Method in class lejos.pc.comm.NXTConnector
 
getObjectColor(int) - Method in class lejos.nxt.addon.NXTCam
Get the color number for a tracked object
getOS() - Method in class lejos.util.jni.OSInfo
Get the name of the OS.
getOSInfo() - Method in class lejos.util.jni.JNILoader
 
getOutputState(int) - Method in class lejos.nxt.remote.NXTCommand
Retrieves the current output state for a port.
getOutputStream() - Method in class lejos.nxt.rcxcomm.RCXAbstractPort
Returns an output stream for this RCXPort.
getOutputStream() - Method in interface lejos.pc.comm.NXTComm
Return an OutputStream for writing a stream of data to the NXT over this connection.
getOutputStream() - Method in class lejos.pc.comm.NXTCommBluecove
 
getOutputStream() - Method in class lejos.pc.comm.NXTCommBluez
 
getOutputStream() - Method in class lejos.pc.comm.NXTCommUSB
 
getOutputStream() - Method in class lejos.pc.comm.NXTConnector
 
getP1() - Method in class lejos.geom.Line
 
getP2() - Method in class lejos.geom.Line
 
getParticle(int) - Method in class lejos.robotics.localization.MCLParticleSet
Get a specific particle
getParticles() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the particle set
getPathFinder() - Method in class lejos.robotics.navigation.NavPathController
 
getPhase() - Method in class lejos.nxt.addon.RCXRotationSensor
Returns the current phase of the sensor.
getPivot() - Method in class lejos.util.LUDecomposition
Return pivot permutation vector
getPose() - Method in class lejos.robotics.localization.MCLParticle
Return the pose of this particle
getPose() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the best best estimate of the current pose;
getPose() - Method in class lejos.robotics.localization.OdometryPoseProvider
returns a new pose that represents the current location and heading of the robot.
getPose() - Method in interface lejos.robotics.localization.PoseProvider
 
getPose() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Returns a new updated Pose
getPose() - Method in class lejos.robotics.navigation.WayPoint
Return a Pose that represents the way point.
getPoseProvider() - Method in class lejos.robotics.navigation.NavPathController
 
getPoseProvider() - Method in interface lejos.robotics.navigation.PathController
Get a reference to the PoseProvider being used as a localizer.
getPower() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Returns the current motor power setting (%).
getPower() - Method in class lejos.nxt.addon.PFMateMotor
 
getPower() - Method in class lejos.nxt.BasicMotor
 
getPower() - Method in class lejos.nxt.remote.RemoteMotor
Return the power that the motor is set to
getPower() - Method in interface lejos.robotics.DCMotor
Returns the current motor power setting.
getPredecessor() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
get the predecessor of this node in the shortest path from the start
getPredecessor() - Method in class lejos.robotics.pathfinding.Node
Used by A* search.
getPredecessor() - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
get the predecessor of this node in the shortest path from the start
getPredictedCovariance() - Method in class lejos.util.KalmanFilter
 
getPredictedMean() - Method in class lejos.util.KalmanFilter
 
getProductID() - Method in class lejos.nxt.addon.SensorMux
Method used to know the Product ID
getProductID() - Method in class lejos.nxt.I2CSensor
Returns the Product ID as a string.
getProtocolVersion() - Static method in class lejos.nxt.NXT
Get the LEGO Communication Protocol version number
getPulse() - Method in class lejos.nxt.addon.LMotor
This method return current pulse over a RC Servo or a DC Motor.
getPulse() - Method in class lejos.nxt.addon.MServo
Return the pulse used in last operation
getRange() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Returns the range to the object in centimeters.
getRange() - Method in class lejos.nxt.UltrasonicSensor
Get the range to the nearest object
getRange() - Method in interface lejos.robotics.RangeFinder
Get the range to the nearest object
getRange() - Method in class lejos.robotics.RangeReading
Get the range reading
getRange(int) - Method in class lejos.robotics.RangeReadings
Get a specific range reading
getRange(float) - Method in class lejos.robotics.RangeReadings
Get a range reading for a specific angle
getRangeFinder() - Method in class lejos.robotics.FixedRangeScanner
returns the rangeFinder - allows other objects to get a range value.
getRangeFinder() - Method in interface lejos.robotics.RangeScanner
Return the range finder for use by other classes
getRangeFinder() - Method in class lejos.robotics.RotatingRangeScanner
returns the rangeFinder - allows other objects to get a range value.
getRangeReading() - Method in interface lejos.robotics.objectdetection.Feature
Returns the RangeReading for this particular detected feature.
getRangeReading() - Method in class lejos.robotics.objectdetection.RangeFeature
 
getRangeReadings() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns most recent range readings
getRangeReadings() - Method in interface lejos.robotics.objectdetection.Feature
Returns a set of RangeReadings for a number of detected objects.
getRangeReadings() - Method in class lejos.robotics.objectdetection.RangeFeature
 
getRanges() - Method in class lejos.nxt.addon.OpticalDistanceSensor
 
getRanges() - Method in class lejos.nxt.UltrasonicSensor
 
getRanges() - Method in interface lejos.robotics.RangeFinder
If the sensor is capable, this method returns multiple range values from a single scan.
getRangeValues() - Method in class lejos.robotics.FixedRangeScanner
Return a set of range readings determined taken at the relative bearings defined in the angles array; The robot rotates back to its original heading at the end.
getRangeValues() - Method in interface lejos.robotics.RangeScanner
Take a set of range readings.
getRangeValues() - Method in class lejos.robotics.RotatingRangeScanner
Returns a set of Range Readings taken the angles specified.
getRate() - Method in class lejos.nxt.addon.CruizcoreGyro
Gets the rate.
getRawColor() - Method in class lejos.nxt.ColorSensor
Return a Color Object that contains the raw color readings.
getRawLightValue() - Method in class lejos.nxt.ColorSensor
Return the Raw light reading.
getRawTachoCount() - Method in class lejos.nxt.addon.RCXRotationSensor
Returns the raw values from the rotation sensor instead of degrees.
getReading(int, RangeReadings, RangeMap) - Method in class lejos.robotics.localization.MCLParticle
Get a specific reading
getReadingLimit(int, NXTLineLeader.LineColor) - Method in class lejos.nxt.addon.NXTLineLeader
Get the calibration value for white and black colors for a given sensor
getRectangle(int) - Method in class lejos.nxt.addon.NXTCam
Get the rectangle containing a tracked object
getRed() - Method in class lejos.robotics.Color
Returns the red component in the range 0-255 in the default sRGB space.
getRelativeHeading() - Method in class lejos.nxt.addon.GPSSensor
Read the current relative heading in degrees Angle travelled since last request.
getResult() - Method in class lejos.nxt.addon.NXTLineLeader
Get result value
getRGBComponent(int) - Method in class lejos.nxt.addon.ColorSensorHT
Returns a single color component, specified by using an enumeration constant as a parameter.
getRGBNormalized(int) - Method in class lejos.nxt.addon.ColorSensorHT
Returns the normalized color component.
getRGBRaw(int) - Method in class lejos.nxt.addon.ColorSensorHT
Returns the raw saturation of the color.
getRight() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. returns the right motor.
getRightCount() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. Returns the tachoCount of the right motor
getRightX() - Method in class lejos.nxt.addon.PSPNXController
 
getRightY() - Method in class lejos.nxt.addon.PSPNXController
 
getRotateMaxSpeed() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getRotateMaxSpeed() - Method in interface lejos.robotics.navigation.RotateMoveController
returns the maximum value of the rotation speed;
getRotateSpeed() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getRotateSpeed() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
getRotateSpeed() - Method in class lejos.robotics.navigation.Move
Get the rotate speed
getRotateSpeed() - Method in interface lejos.robotics.navigation.RotateMoveController
Returns the value of the rotation speed
getRotationCount() - Method in class lejos.nxt.remote.RemoteMotor
Deprecated.  
getRotationSpeed() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Returns the actual speed.
getRotationSpeed() - Method in class lejos.nxt.addon.NXTMMXMotor
same as get speed I need to work on this still
getRotationSpeed() - Method in class lejos.nxt.addon.RCXRotationSensor
 
getRotationSpeed() - Method in class lejos.nxt.remote.RemoteMotor
 
getRotationSpeed() - Method in interface lejos.robotics.Tachometer
Returns the actual speed.
getRotationsPerMinute() - Method in class lejos.nxt.addon.AngleSensor
 
getRoute(DijkstraPathFinder.Node) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
helper method for find path()
calculates the route backtracking through predecessor chain
getRoute(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
helper method for find path()
calculates the route backtracking through predecessor chain
getRowDimension() - Method in class lejos.util.Matrix
Get row dimension.
getRowPackedCopy() - Method in class lejos.util.Matrix
Make a one-dimensional row packed copy of the internal array.
getRPM() - Method in class lejos.nxt.addon.AngleSensor
reads the current rotations per minute
getScanner() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the range scanner
getSecond() - Method in interface lejos.robotics.Clock
 
getSensorModule() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Used to determine the sensor module that is configured.
getSensorStatus(int) - Method in class lejos.nxt.addon.NXTLineLeader
Deprecated.  
getSensorType() - Method in class lejos.nxt.addon.SensorMux
Method used to know the type of the sensor
getSensorType() - Method in class lejos.nxt.I2CSensor
Returns the type of sensor as a string.
getSensorValue(int) - Method in class lejos.nxt.addon.IRSeeker
Returns value of sensor 1 - 5.
getSensorValue(int) - Method in class lejos.nxt.addon.IRSeekerV2
Returns value of sensor 1 - 5.
getSensorValues() - Method in class lejos.nxt.addon.IRSeekerV2
Gets the values of each sensor, returning them in an array.
getSerialNo() - Method in class lejos.nxt.addon.RFIDSensor
Obtain the serial number of the RFID Sensor.
getServo(int) - Method in class lejos.nxt.addon.LSC
Method to get an RC Servo in a LSC
getServo(int) - Method in class lejos.nxt.addon.MSC
Method to get an RC Servo in from the NXTServo
getSetPoint() - Method in class lejos.nxt.addon.NXTLineLeader
Get the set point of the PID.
getSigmaHeading() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the standard deviation of the heading values in the particle set;
getSigmaX() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the standard deviation of the X values in the particle set;
getSigmaY() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the standard deviation of the Y values in the particle set;
getSignalStrength() - Static method in class lejos.nxt.NXT
This doesn't seem to be implemented in Lego NXT firmware/protocol?
getSingleton() - Static method in class lejos.nxt.remote.NXTCommand
Get the singleton NXTCommand object.
getSingletonOpen() - Static method in class lejos.pc.comm.NXTCommandConnector
Ensure that the singleton NXTCommand object has been opened and return it.
getSourceDistance() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
return the shortest path length to this node from the start node
getSourceDistance() - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
return the shortest path length to this node from the start node
getSpeed() - Method in class lejos.nxt.addon.LDCMotor
Method to get speed from the DC Motor
getSpeed() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Return the current target speed.
getSpeed() - Method in class lejos.nxt.addon.NXTMMXMotor
return the set speed of the motor.
getSpeed() - Method in class lejos.nxt.addon.PFMateMotor
returns the speed
getSpeed(int) - Method in class lejos.nxt.addon.RCXMotorMultiplexer
 
getSpeed() - Method in class lejos.nxt.remote.RemoteMotor
 
getSpeed() - Method in interface lejos.robotics.RegulatedMotor
Returns the current motor speed.
getStatus() - Method in class lejos.nxt.addon.RCXLink
 
getStatus() - Method in class lejos.nxt.addon.RFIDSensor
Read the status from the device.
getSteering() - Method in class lejos.nxt.addon.NXTLineLeader
Get the steering value
getTachoCount() - Method in class lejos.nxt.addon.LinearActuator
Returns the tachometer (encoder) count.
getTachoCount() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Returns the tachometer count.
getTachoCount() - Method in class lejos.nxt.addon.NXTMMXMotor
Returns the tachometer count.
getTachoCount() - Method in class lejos.nxt.addon.RCXRotationSensor
Returns the tachometer count.
getTachoCount() - Method in class lejos.nxt.MotorPort
 
getTachoCount(int) - Method in class lejos.nxt.remote.NXTCommand
Retrieves tacho count.
getTachoCount() - Method in class lejos.nxt.remote.RemoteMotor
 
getTachoCount() - Method in class lejos.nxt.remote.RemoteMotorPort
 
getTachoCount() - Method in interface lejos.nxt.Tachometer
 
getTachoCount() - Method in interface lejos.robotics.Encoder
Returns the tachometer count.
getTimeOut() - Method in class lejos.nxt.rcxcomm.RCXAbstractPort
Getter for property timeOut.
getTimeStamp() - Method in class lejos.robotics.navigation.Move
The time stamp is the system clock at the time the Move object is created.
getTimeStamp() - Method in interface lejos.robotics.objectdetection.Feature
The time-stamp is the recorded system time when the range reading was taken.
getTimeStamp() - Method in class lejos.robotics.objectdetection.RangeFeature
 
getTimeString() - Method in interface lejos.robotics.Clock
 
getTravelDistance() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
getTravelSpeed() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getTravelSpeed() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
getTravelSpeed() - Method in class lejos.robotics.navigation.Move
Get the travel speed
getTravelSpeed() - Method in interface lejos.robotics.navigation.MoveController
Returns the speed at which the robot will travel forward and backward (and to some extent arcs, although actual arc speed is slightly less).
getTravelSpeed() - Method in class lejos.robotics.navigation.SteeringPilot
 
getTriangleAngle(Point, Point, Point) - Static method in class lejos.robotics.navigation.ArcAlgorithms
This method calculates the angle generated by three points.
getTurnRatio() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. Returns the ratio of motor revolutions per 360 degree rotation of the robot
getTurnSpeed() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. 
getType() - Method in class lejos.nxt.addon.SensorMux
Return the type
getType() - Method in interface lejos.nxt.BasicSensorPort
 
getType() - Method in class lejos.nxt.SensorPort
 
getU() - Method in class lejos.util.LUDecomposition
Return upper triangular factor
getUnits() - Method in class lejos.nxt.UltrasonicSensor
Return a string indicating the type of units in use by the unit.
getUTC() - Method in class lejos.nxt.addon.GPSSensor
Get the current time stored on the dGPS
getVelocity() - Method in class lejos.nxt.addon.GPSSensor
Read the current velocity in cm/s
getVersion() - Method in class lejos.nxt.addon.SensorMux
Method used to know the version
getVersion() - Method in class lejos.nxt.I2CSensor
Returns the version number of the sensor hardware.
getVersion() - Method in class lejos.pc.comm.NXTSamba
returns the SAM-BA version string for the current device.
getVoltage() - Method in class lejos.nxt.addon.NXTMMX
Returns the voltage in millivolts
getVoltage() - Static method in class lejos.nxt.Battery
The NXT uses 6 batteries of 1.5 V each.
getVoltage() - Method in class lejos.nxt.remote.RemoteBattery
The NXT uses 6 batteries of 1.5 V each.
getVoltageMilliVolt() - Static method in class lejos.nxt.Battery
The NXT uses 6 batteries of 1500 mV each.
getVoltageMilliVolt() - Method in class lejos.nxt.remote.RemoteBattery
The NXT uses 6 batteries of 1500 mV each.
getVoltLSB() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Returns the current voltage level in millivolts for the LSB.
getVoltMSB() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Returns the current voltage level in millivolts for the MSB.
getVoltPointLSB(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets millivolts value of the specific index for the LSB.
getVoltPointMSB(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Gets millivolts value of the specific index for the MSB.
getWayPoint() - Method in class lejos.robotics.navigation.NavPathController
Returns the waypoint to which the robot is moving
getWeight() - Method in class lejos.robotics.localization.MCLParticle
Return the weight of this particle
getX() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. gets the current value of the X coordinate
getX() - Method in class lejos.robotics.navigation.Pose
Get the X coordinate
getX() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
get the X coordinate of this node
getX() - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
get the X coordinate of this node
getXAccel() - Method in class lejos.nxt.addon.AccelHTSensor
Acceleration along X axis.
getXAccel() - Method in class lejos.nxt.addon.AccelMindSensor
Acceleration along X axis.
getXAccel() - Method in interface lejos.robotics.Accelerometer
 
getXRange() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the difference between max X and min X
getXTilt() - Method in class lejos.nxt.addon.AccelHTSensor
Tilt of sensor along X-axis.
getXTilt() - Method in class lejos.nxt.addon.AccelMindSensor
Tilt of sensor along X-axis (see top of Mindsensors.com sensor for diagram of axis).
getXTilt() - Method in interface lejos.robotics.Accelerometer
 
getY() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. gets the current value of the Y coordinate
getY() - Method in class lejos.robotics.navigation.Pose
Get the Y coordinate
getY() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
get the Y coordinate of thes Node
getY() - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
get the Y coordinate of thes Node
getYAccel() - Method in class lejos.nxt.addon.AccelHTSensor
Acceleration along Y axis.
getYAccel() - Method in class lejos.nxt.addon.AccelMindSensor
Acceleration along Y axis.
getYAccel() - Method in interface lejos.robotics.Accelerometer
 
getYear() - Method in interface lejos.robotics.Clock
 
getYRange() - Method in class lejos.robotics.localization.MCLPoseProvider
Return difference between max Y and min Y
getYTilt() - Method in class lejos.nxt.addon.AccelHTSensor
Returns Y tilt value.
getYTilt() - Method in class lejos.nxt.addon.AccelMindSensor
Returns Y tilt value.
getYTilt() - Method in interface lejos.robotics.Accelerometer
 
getZAccel() - Method in class lejos.nxt.addon.AccelHTSensor
Acceleration along Z axis.
getZAccel() - Method in class lejos.nxt.addon.AccelMindSensor
Acceleration along Z axis.
getZAccel() - Method in interface lejos.robotics.Accelerometer
 
getZTilt() - Method in class lejos.nxt.addon.AccelHTSensor
Returns Z tilt value.
getZTilt() - Method in class lejos.nxt.addon.AccelMindSensor
Returns Z tilt value.
getZTilt() - Method in interface lejos.robotics.Accelerometer
 
goTo(float, float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Robot moves to grid coordinates x,y.
goTo(float, float, boolean) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Robot moves to grid coordinates x,y.
goTo(WayPoint, boolean) - Method in class lejos.robotics.navigation.NavPathController
This method will navigate to a point.
goTo(WayPoint) - Method in class lejos.robotics.navigation.NavPathController
This method will navigate to a point.
goTo(double, double) - Method in class lejos.robotics.navigation.NavPathController
This method will navigate to a point.
goTo(WayPoint, boolean) - Method in interface lejos.robotics.navigation.PathController
This method causes the robot to travel to a new location.
goTo(WayPoint) - Method in interface lejos.robotics.navigation.PathController
This method causes the robot to travel to a new location.
goTo(double, double) - Method in interface lejos.robotics.navigation.PathController
This method causes the robot to travel to a new location.
goToInitAngle() - Method in class lejos.nxt.addon.LServo
Method to set medium angle
goToMaxAngle() - Method in class lejos.nxt.addon.LServo
Method to set maximum angle
goToMiddleAngle() - Method in class lejos.nxt.addon.LServo
Method to set medium angle
goToMinAngle() - Method in class lejos.nxt.addon.LServo
Method to set minimal angle
GP2D12 - Static variable in class lejos.nxt.addon.OpticalDistanceSensor
 
GP2D120 - Static variable in class lejos.nxt.addon.OpticalDistanceSensor
DIST-Nx-Short
GP2YA02 - Static variable in class lejos.nxt.addon.OpticalDistanceSensor
DIST-Nx-Long
GP2YA21 - Static variable in class lejos.nxt.addon.OpticalDistanceSensor
DIST-Nx-Medium
GPSSensor - Class in lejos.nxt.addon
Class for controlling dGPS sensor from Dexter Industries
GPSSensor(I2CPort) - Constructor for class lejos.nxt.addon.GPSSensor
Constructor
GRAY - Static variable in class lejos.robotics.Color
 
GREEN - Static variable in interface lejos.nxt.SensorConstants
 
GREEN - Static variable in class lejos.robotics.Color
 
GREEN_INDEX - Static variable in interface lejos.nxt.SensorConstants
Color sensor data GREEN value index.
GridNode - Class in lejos.robotics.pathfinding
 
GridNode(float, float, float) - Constructor for class lejos.robotics.pathfinding.GridNode
 
GyroDirectionFinder - Class in lejos.nxt.addon
Implementation of the DirectionFinder interface that integrates repeated rate-of-turn readings from a GyroSensor into a continuously updated heading.
GyroDirectionFinder(GyroSensor) - Constructor for class lejos.nxt.addon.GyroDirectionFinder
Creates and initializes a new GyroDirectionFinder using passed GyroSensor
GyroDirectionFinder(GyroSensor, boolean) - Constructor for class lejos.nxt.addon.GyroDirectionFinder
Creates and initializes a new GyroDirectionFinder using passed GyroSensor and does the GyroSensor.recalibrateOffset() method.
Gyroscope - Interface in lejos.robotics
Abstraction for Gryoscope defines minimal implementation
GyroSensor - Class in lejos.nxt.addon
Support the HiTechnic Gyro sensor.
GyroSensor(ADSensorPort) - Constructor for class lejos.nxt.addon.GyroSensor
Creates and initializes a new GyroSensor bound to passed ADSensorPort.
GyroSensor(ADSensorPort, int) - Constructor for class lejos.nxt.addon.GyroSensor
Creates and initializes a new GyroSensor bound to passed ADSensorPort and sets the offset to be used in GyroSensor.readValue().

H

HANDLE_ALREADY_CLOSED - Static variable in interface lejos.nxt.remote.ErrorMessages
 
hasDirection() - Method in class lejos.nxt.addon.IRSeekerV2
 
head - Variable in class lejos.robotics.RotatingRangeScanner
 
heading - Variable in class lejos.robotics.navigation.WayPoint
 
headingRequired - Variable in class lejos.robotics.navigation.WayPoint
 
HIGH_SPEED_BUFFER - Static variable in interface lejos.nxt.remote.NXTProtocol
 
HTANGLE_MODE_CALIBRATE - Variable in class lejos.nxt.addon.AngleSensor
 
HTANGLE_MODE_RESET - Variable in class lejos.nxt.addon.AngleSensor
 

I

I2CPort - Interface in lejos.nxt
Abstraction for a port that supports I2C sensors.
I2CSensor - Class in lejos.nxt
A sensor wrapper to allow easy access to I2C sensors, like the ultrasonic sensor.
I2CSensor(I2CPort) - Constructor for class lejos.nxt.I2CSensor
 
I2CSensor(I2CPort, int) - Constructor for class lejos.nxt.I2CSensor
 
I2CSensor(I2CPort, int, int, int) - Constructor for class lejos.nxt.I2CSensor
 
ID_T1 - Static variable in class lejos.nxt.addon.TouchMUX
Bit ID returned by readSensors when sensor T1 is pressed
ID_T2 - Static variable in class lejos.nxt.addon.TouchMUX
Bit ID returned by readSensors when sensor T1 is pressed
ID_T3 - Static variable in class lejos.nxt.addon.TouchMUX
Bit ID returned by readSensors when sensor T1 is pressed
identity(int, int) - Static method in class lejos.util.Matrix
Generate identity matrix
ILLEGAL_FILE_NAME - Static variable in interface lejos.nxt.remote.ErrorMessages
 
ILLEGAL_HANDLE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
ILLEGAL_MAILBOX_QUEUE_ID_SPECIFIED - Static variable in interface lejos.nxt.remote.ErrorMessages
 
ILLEGAL_SIZE_SPECIFIED - Static variable in interface lejos.nxt.remote.ErrorMessages
 
in - Static variable in class lejos.pc.comm.SystemContext
Deprecated.  
Inbox - Class in lejos.nxt
The message class is used to send messages between NXT bricks.
Inbox() - Constructor for class lejos.nxt.Inbox
 
inc - Static variable in class lejos.nxt.addon.RCXRotationSensor
The following table when indexed by [previous phase][current phase] provides the current direction of rotation.
inCandidateSet(DijkstraPathFinder.Node) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
helper method for findPath; check if aNode is in the set of candidate nodes
inCandidateSet(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
helper method for findPath; check if aNode is in the set of candidate nodes
incomplete() - Method in class lejos.robotics.RangeReadings
Return true if the readings are incomplete
incompleteRanges() - Method in class lejos.robotics.localization.MCLPoseProvider
returns range scanner failure status
init(SensorPort) - Static method in class lejos.nxt.rcxcomm.LLC
Initialize LLC and set port
init() - Static method in class lejos.nxt.rcxcomm.LLC
Initialize LLC an
initBlackLevel() - Method in class lejos.nxt.addon.ColorSensorHT
Puts the sensor into black/ambient level calibration mode.
initialize(byte) - Method in class lejos.nxt.addon.PFLink
Should be called once to set up the NRLink for usage in the program
initialize(JNILoader) - Method in class lejos.pc.comm.NXTCommBluez
 
initialize(JNILoader) - Method in class lejos.pc.comm.NXTCommFantom
 
initialize(JNILoader) - Method in class lejos.pc.comm.NXTCommLibnxt
 
initialize() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
 
initialize() - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
initialize(JNILoader) - Method in interface lejos.util.jni.JNIClass
Return false, if the
initWhiteBalance() - Method in class lejos.nxt.addon.ColorSensorHT
Puts the sensor into white balance calibration mode.
inputPort - Variable in class lejos.nxt.remote.InputValues
 
InputValues - Class in lejos.nxt.remote
Sensor input values for a remote NXT accessed via LCP.
InputValues() - Constructor for class lejos.nxt.remote.InputValues
 
inquiryCompleted(int) - Method in class lejos.pc.comm.NXTCommBluecove
 
inReachedSet(DijkstraPathFinder.Node) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
helper method for findPath; check if aNode is in the set of reached nodes
inReachedSet(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
helper method for findPath; check if aNode is in the set of reached nodes
INSANE_PACKET - Static variable in interface lejos.nxt.remote.ErrorMessages
 
inside(Point) - Method in class lejos.robotics.mapping.LineMap
Check if a point is within the mapped area
inside(Point) - Method in interface lejos.robotics.mapping.RangeMap
Test if a point is within the mapped area
installDefaultMacros() - Method in class lejos.nxt.addon.PFLink
Installs the macro definitions used by this class.
installMacro(int, byte[]) - Method in class lejos.nxt.addon.PFLink
Installs a macro into the NRLink You really should call this only once for a new NRLink since it stores them in EEPROM even if turned of.
INSUFFICIENT_MEMORY_AVAILABLE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
interrupt() - Method in class lejos.robotics.navigation.NavPathController
 
interrupt() - Method in interface lejos.robotics.navigation.PathController
Stops the robot immediately; preserves the rest of the queue
intersectsAt(Line) - Method in class lejos.geom.Line
Calculate the point of intersection of two lines.
INVALID_MODE - Static variable in class lejos.nxt.BasicMotor
 
invalidReading() - Method in class lejos.robotics.RangeReading
Test if reading is invalid
inverse() - Method in class lejos.util.Matrix
Matrix inverse or pseudoinverse
IRLink - Class in lejos.nxt.addon
Supports for HiTechnic IRLink - see http://www.hitechnic.com/.
IRLink(I2CPort) - Constructor for class lejos.nxt.addon.IRLink
 
IRSeeker - Class in lejos.nxt.addon
HiTechnic IRSeeker sensor - untested.
IRSeeker(I2CPort) - Constructor for class lejos.nxt.addon.IRSeeker
 
IRSeekerV2 - Class in lejos.nxt.addon
 
IRSeekerV2(I2CPort, IRSeekerV2.Mode) - Constructor for class lejos.nxt.addon.IRSeekerV2
 
IRSeekerV2.Mode - Enum in lejos.nxt.addon
 
IRTransmitter - Interface in lejos.nxt.addon
Interface for infra-red transmitters that can send bytes to an RCX
isAckAvailable() - Method in class lejos.nxt.rcxcomm.LLCHandler
Check if an Ack is available
isAckAvailable() - Method in class lejos.nxt.rcxcomm.PacketHandler
Check if an ack is available
isArch(String) - Method in class lejos.util.jni.OSInfo
 
isAutoStart() - Method in class lejos.nxt.addon.NXTMMX
Determines if motors will automatically start or not.
isBackward() - Method in class lejos.nxt.addon.PFMateMotor
Determines if motor is moving backwards this is based on what the receiver has in its registers
isBatteryLow() - Method in class lejos.nxt.addon.SensorMux
Method used to get if battery status is low.
isBusy() - Method in class lejos.robotics.localization.MCLPoseProvider
returns true if particle weights are being updated.
isCalibrated - Variable in class lejos.nxt.remote.InputValues
 
isEnabled() - Method in interface lejos.robotics.objectdetection.FeatureDetector
Indicates if automatic scanning mode and listener notification is currently enabled.
isEnabled() - Method in class lejos.robotics.objectdetection.FeatureDetectorAdapter
 
isEnabled() - Method in class lejos.robotics.objectdetection.FusorDetector
 
isFloodlightOn() - Method in class lejos.nxt.addon.RCXLightSensor
 
isFloodlightOn() - Method in class lejos.nxt.ColorSensor
 
isFloodlightOn() - Method in class lejos.nxt.LightSensor
 
isFloodlightOn() - Method in interface lejos.robotics.LampLightDetector
Checks if the floodlight is currently on.
isFlt() - Method in class lejos.nxt.addon.PFMateMotor
Determines if motor is floating this is based on what the receiver has in its registers
isForward() - Method in class lejos.nxt.addon.PFMateMotor
Determines if motor is moving forward this is based on what the receiver has in its registers
isGoing() - Method in class lejos.robotics.navigation.NavPathController
returns false if the the final waypoint has been reached or interrupt() has been called
isLost() - Method in class lejos.robotics.localization.MCLPoseProvider
returns lost status - all particles have very low probability weights
isMoving() - Method in class lejos.nxt.addon.LinearActuator
Returns true if the actuator is in motion.
isMoving() - Method in class lejos.nxt.addon.LMotor
Method to know if Servo is moving to a determinated angle
isMoving() - Method in class lejos.nxt.addon.MMXRegulatedMotor
This method returns true if the motor is rotating, whether under power or not.
isMoving() - Method in class lejos.nxt.addon.NXTMMXMotor
Returns true if the motor is in motion.
isMoving() - Method in class lejos.nxt.addon.PFMateMotor
 
isMoving() - Method in class lejos.nxt.BasicMotor
Returns true iff the motor is in motion.
isMoving() - Method in class lejos.nxt.remote.RemoteMotor
 
isMoving() - Method in interface lejos.robotics.BaseMotor
Return true if the motor is moving.
isMoving() - Method in class lejos.robotics.navigation.DifferentialPilot
 
isMoving() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. returns true if the robot is moving
isMoving() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
isMoving() - Method in class lejos.robotics.navigation.Move
Test if move was in progress
isMoving() - Method in interface lejos.robotics.navigation.MoveController
true if the robot is moving
isMoving() - Method in class lejos.robotics.navigation.SteeringPilot
 
isNonsingular() - Method in class lejos.util.LUDecomposition
Is the matrix nonsingular?
isOpen() - Method in class lejos.nxt.remote.NXTCommand
Test is connection is open
isOS(String) - Method in class lejos.util.jni.OSInfo
 
isOverloaded() - Method in class lejos.nxt.addon.NXTMMXMotor
Determines if the motor stalled due to over load.
isPacketAvailable() - Method in class lejos.nxt.rcxcomm.LLCHandler
Check if a packet is available
isPacketAvailable() - Method in class lejos.nxt.rcxcomm.LLCReliableHandler
Check if a packet is available.
isPacketAvailable() - Method in class lejos.nxt.rcxcomm.PacketHandler
Check if a packet is available
isPacketAvailable() - Static method in class lejos.nxt.rcxcomm.Serial
Test if a packet is available
isPressed(int) - Method in class lejos.nxt.addon.SensorMux
Method used to manage a Touch Sensor
isPressed() - Method in class lejos.nxt.TouchSensor
Check if the sensor is pressed.
isPressed() - Method in interface lejos.robotics.Touch
Check if the sensor is pressed.
isRamping() - Method in class lejos.nxt.addon.NXTMMXMotor
Determines if the motor is ramping up or down.
isRegulating() - Method in class lejos.nxt.addon.NXTMMXMotor
Determine whether speed control is on or not
isRotating() - Method in class lejos.nxt.remote.RemoteMotor
CURRENTLY NOT IMPLEMENTED! Use isMoving() for now.
isSendError() - Static method in class lejos.nxt.rcxcomm.LLC
Return the error status of the last send
isSending() - Static method in class lejos.nxt.rcxcomm.LLC
Indicate whether the last send is still active
isSmoothAcceleration() - Method in class lejos.nxt.addon.NXTMMXMotor
Determines if speed ramping is enabled
isStalled() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Return true if the motor is currently stalled after a motor action method is executed.
isStalled() - Method in class lejos.nxt.addon.NXTMMXMotor
Determines if the motor is stalled or not
isStalled() - Method in class lejos.nxt.remote.RemoteMotor
 
isStalled() - Method in class lejos.robotics.navigation.DifferentialPilot
 
isStalled() - Method in interface lejos.robotics.RegulatedMotor
returns true if motor is stalled
isStop() - Method in class lejos.nxt.addon.PFMateMotor
Determines if motor is stopped this is based on what the receiver has in its registers
isTaskRunning() - Method in class lejos.nxt.addon.NXTMMXMotor
Determines if the motor is running a task.
isTraveling() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. returns returns true if the robot is travelling for a specific distance;
isUpdated() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns update success flag

J

jfantom_close(long) - Method in class lejos.pc.comm.NXTCommFantom
 
jfantom_find() - Method in class lejos.pc.comm.NXTCommFantom
 
jfantom_open(String) - Method in class lejos.pc.comm.NXTCommFantom
 
jfantom_read_data(long, byte[], int, int) - Method in class lejos.pc.comm.NXTCommFantom
 
jfantom_send_data(long, byte[], int, int) - Method in class lejos.pc.comm.NXTCommFantom
 
jlibnxt_close(long) - Method in class lejos.pc.comm.NXTCommLibnxt
 
jlibnxt_find() - Method in class lejos.pc.comm.NXTCommLibnxt
 
jlibnxt_open(String) - Method in class lejos.pc.comm.NXTCommLibnxt
 
jlibnxt_read_data(long, byte[], int, int) - Method in class lejos.pc.comm.NXTCommLibnxt
 
jlibnxt_send_data(long, byte[], int, int) - Method in class lejos.pc.comm.NXTCommLibnxt
 
JNIClass - Interface in lejos.util.jni
 
JNIException - Exception in lejos.util.jni
 
JNIException() - Constructor for exception lejos.util.jni.JNIException
 
JNIException(String) - Constructor for exception lejos.util.jni.JNIException
 
JNIException(Throwable) - Constructor for exception lejos.util.jni.JNIException
 
JNIException(String, Throwable) - Constructor for exception lejos.util.jni.JNIException
 
JNILoader - Class in lejos.util.jni
 
JNILoader() - Constructor for class lejos.util.jni.JNILoader
 
JNILoader(String, OSInfo) - Constructor for class lejos.util.jni.JNILoader
 
jump(int) - Method in class lejos.pc.comm.NXTSamba
Start execution of code at the specified address.

K

KalmanFilter - Class in lejos.util
 
KalmanFilter(Matrix, Matrix, Matrix, Matrix, Matrix) - Constructor for class lejos.util.KalmanFilter
 
KEEP_ALIVE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
KEY_LEFTMOTOR - Static variable in class lejos.util.PilotProps
 
KEY_REVERSE - Static variable in class lejos.util.PilotProps
 
KEY_RIGHTMOTOR - Static variable in class lejos.util.PilotProps
 
KEY_TRACKWIDTH - Static variable in class lejos.util.PilotProps
 
KEY_WHEELDIAMETER - Static variable in class lejos.util.PilotProps
 

L

LampLightDetector - Interface in lejos.robotics
Interface for a light sensor that also includes a lamp (usually LED) to provide illumination.
LCP - Static variable in interface lejos.pc.comm.NXTComm
 
LDCMotor - Class in lejos.nxt.addon
LDCMotor, Lattebox DC Motor, is a abstraction to model any DCMotor connected to LSC, Lattebox Servo Controller.
LDCMotor(SensorPort, int, String, byte) - Constructor for class lejos.nxt.addon.LDCMotor
Constructor
LDCMotor(SensorPort, int, String, byte, int, int, int, int) - Constructor for class lejos.nxt.addon.LDCMotor
 
leftOrth() - Method in class lejos.geom.Point
 
LegacyNavigator - Class in lejos.robotics.navigation
Deprecated. This class will disappear in NXJ version 1.0. Use a PathController instead.
LegacyNavigator(LegacyPilot) - Constructor for class lejos.robotics.navigation.LegacyNavigator
Deprecated. Allocates a LegacyNavigator with a Pilot that you supply.
LegacyNavigator(float, float, RegulatedMotor, RegulatedMotor, boolean) - Constructor for class lejos.robotics.navigation.LegacyNavigator
Deprecated. The correct way is to create the Pilot in advance and to use that in construction of the LegacyNavigator. Otherwise the LegacyNavigator needs to know detail it should not care about!
LegacyNavigator(float, float, RegulatedMotor, RegulatedMotor) - Constructor for class lejos.robotics.navigation.LegacyNavigator
Deprecated. The correct way is to create the Pilot in advance and to use that in construction of the LegacyNavigator. Otherwise the LegacyNavigator needs to know detail it should not care about!
LegacyPilot - Class in lejos.robotics.navigation
Deprecated. This class will disappear in NXJ version 1.0. Use an implementing class of MoveController instead.
LegacyPilot(float, float, RegulatedMotor, RegulatedMotor) - Constructor for class lejos.robotics.navigation.LegacyPilot
Deprecated. Allocates a LegacyPilot object, and sets the physical parameters of the NXT robot.
Assumes Motor.forward() causes the robot to move forward.
LegacyPilot(float, float, RegulatedMotor, RegulatedMotor, boolean) - Constructor for class lejos.robotics.navigation.LegacyPilot
Deprecated. Allocates a LegacyPilot object, and sets the physical parameters of the NXT robot.
LegacyPilot(float, float, float, RegulatedMotor, RegulatedMotor, boolean) - Constructor for class lejos.robotics.navigation.LegacyPilot
Deprecated. Allocates a LegacyPilot object, and sets the physical parameters of the NXT robot.
LegacySensorPort - Interface in lejos.nxt
Abstraction for a port that supports legacy RCX sensors.
LEGO_MODE - Static variable in interface lejos.nxt.I2CPort
 
lejos.geom - package lejos.geom
Geometric shape support for robotics using float co-ordinates
lejos.nxt - package lejos.nxt
Access to NXT sensors, motors, etc.
lejos.nxt.addon - package lejos.nxt.addon
Access to third party and legacy RCX sensors, motors and other hardware not included in the Lego NXT kit
lejos.nxt.rcxcomm - package lejos.nxt.rcxcomm
Emulation of RCX communication classes
lejos.nxt.remote - package lejos.nxt.remote
Remote NXT access over Bluetooth
lejos.pc.comm - package lejos.pc.comm
Communication from the PC to the NXT
lejos.robotics - package lejos.robotics
Hardware abstraction interfaces for the robotics package.
lejos.robotics.localization - package lejos.robotics.localization
Localization support
lejos.robotics.mapping - package lejos.robotics.mapping
Support for maps
lejos.robotics.navigation - package lejos.robotics.navigation
Navigation classes.
lejos.robotics.objectdetection - package lejos.robotics.objectdetection
Object detection classes.
lejos.robotics.pathfinding - package lejos.robotics.pathfinding
Path finding classes.
lejos.util - package lejos.util
More utility classes
lejos.util.jni - package lejos.util.jni
 
length() - Method in class lejos.geom.Line
Return the length of the line
length() - Method in class lejos.geom.Point
 
lengthen(float) - Method in class lejos.geom.Line
Make this line longer by an amount delta at each end.
lengthenLines(float) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
lengthens all the lines in the map by delta at each end
lengthenLines(float) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
lengthens all the lines in the map by delta at each end
LIGHT_ACTIVE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
LIGHT_GRAY - Static variable in class lejos.robotics.Color
 
LIGHT_INACTIVE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
LightDetector - Interface in lejos.robotics
A platform independent implementation for sensors that can detect white light levels.
LightSensor - Class in lejos.nxt
This class is used to obtain readings from a LEGO NXT light sensor.
LightSensor(ADSensorPort) - Constructor for class lejos.nxt.LightSensor
Create a light sensor object attached to the specified port.
LightSensor(ADSensorPort, boolean) - Constructor for class lejos.nxt.LightSensor
Create a light sensor object attached to the specified port, and sets floodlighting on or off.
Line - Class in lejos.geom
Represents a line and supports calculating the point of intersection of two line segments.
Line(float, float, float, float) - Constructor for class lejos.geom.Line
 
LINE_TRACKING - Static variable in class lejos.nxt.addon.NXTCam
Used by setTrackingMode() to choose line tracking.
LinearActuator - Class in lejos.nxt.addon
A Linear Actuator class that provides non-blocking actions and stall detection.
LinearActuator(MotorPort) - Constructor for class lejos.nxt.addon.LinearActuator
Create a LinearActuator instance.
LineMap - Class in lejos.robotics.mapping
A map of a room or other closed environment, represented by line segments
LineMap(Line[], Rectangle) - Constructor for class lejos.robotics.mapping.LineMap
Create a map from an array of line segments and a bounding rectangle
LineMap() - Constructor for class lejos.robotics.mapping.LineMap
Constructor to use when map will be loaded from a data stream
lines - Variable in class lejos.pc.comm.MapPanel
 
linkStatus() - Method in class lejos.nxt.addon.GPSSensor
Return status of link to the GPS satellites LED on dGPS should light if satellite lock acquired
listener - Variable in class lejos.nxt.remote.RemoteMotor
 
listeners - Variable in class lejos.robotics.navigation.NavPathController
 
LLC - Class in lejos.nxt.rcxcomm
Emulates RCX LLC class using the RCXLink class.
LLCHandler - Class in lejos.nxt.rcxcomm
Packet handler than implement the LLC packet protocol.
LLCHandler(SensorPort) - Constructor for class lejos.nxt.rcxcomm.LLCHandler
 
LLCReliableHandler - Class in lejos.nxt.rcxcomm
A Packet handler that guarantees reliable delivery using checksums, acks, and a single bit sequence number.
LLCReliableHandler(PacketHandler) - Constructor for class lejos.nxt.rcxcomm.LLCReliableHandler
 
LMotor - Class in lejos.nxt.addon
Generic abstraction to manage RC Servos and DC Motor.
LMotor(SensorPort, int, String, byte) - Constructor for class lejos.nxt.addon.LMotor
Constructor
load() - Method in class lejos.nxt.addon.LMotor
Load Servo located in a position X
loadAllServos() - Method in class lejos.nxt.addon.LSC
Load all servos connected this this LSC
loadEstimation(DataInputStream) - Method in class lejos.robotics.localization.MCLPoseProvider
Load serialized estimated pose from a data input stream
loadLibrary(Class<?>, String) - Method in class lejos.util.jni.JNILoader
 
loadMap(DataInputStream) - Method in class lejos.robotics.mapping.LineMap
Load a map from a DataInputStream
loadParticles(DataInputStream) - Method in class lejos.robotics.localization.MCLParticleSet
Load serialized particles from a data input stream
loadPersistentValues() - Method in class lejos.util.PilotProps
 
loadReadings(DataInputStream) - Method in class lejos.robotics.RangeReadings
Load the readings from a DataInputStream
lock() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Locks the motor in current position.
lock() - Method in class lejos.nxt.addon.NXTMMXMotor
Locks the motor in current position.
log(Throwable) - Method in class lejos.pc.comm.NXTCommLoggable
Log an exception to all the log listeners
log(String) - Method in class lejos.pc.comm.NXTCommLoggable
Log a message to all the log listeners
logEvent(String) - Method in interface lejos.pc.comm.NXTCommLogListener
 
logEvent(Throwable) - Method in interface lejos.pc.comm.NXTCommLogListener
 
LONG_RANGE_IR - Static variable in class lejos.nxt.addon.RCXLink
 
lowerHandler - Variable in class lejos.nxt.rcxcomm.PacketHandler
 
LOWSPEED - Static variable in interface lejos.nxt.remote.NXTProtocol
 
LOWSPEED_9V - Static variable in interface lejos.nxt.remote.NXTProtocol
 
LS_GET_STATUS - Static variable in interface lejos.nxt.remote.NXTProtocol
 
LS_READ - Static variable in interface lejos.nxt.remote.NXTProtocol
 
LS_WRITE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
LSC - Class in lejos.nxt.addon
This class has been defined to manage the device LSC, Lattebox Servo Controller which manage until 10 RC Servos / DC Motors
LSC(SensorPort, byte) - Constructor for class lejos.nxt.addon.LSC
Constructor
LSC_position - Variable in class lejos.nxt.addon.LMotor
 
LServo - Class in lejos.nxt.addon
LServo, Lattebox Servo, is a abstraction to model any RC Servo (continous and non continous) plugged to LSC, Lattebox Servo Controller.
LServo(SensorPort, int, String, byte) - Constructor for class lejos.nxt.addon.LServo
Constructor
LServo(SensorPort, int, String, byte, int, int) - Constructor for class lejos.nxt.addon.LServo
Constructor with the feature to set min and max angle
LServo(SensorPort, int, String, byte, int, int, int) - Constructor for class lejos.nxt.addon.LServo
Constructor with the feature to set min, max and init angle
LSGetStatus(byte) - Method in class lejos.nxt.remote.NXTCommand
Returns the status for an Inter-Integrated Circuit (I2C) sensor (the ultrasound sensor) via the Low Speed (LS) data port.
LSRead(byte) - Method in class lejos.nxt.remote.NXTCommand
Reads data from an Inter-Integrated Circuit (I2C) sensor (the ultrasound sensor) via the Low Speed (LS) data port.
LSWrite(byte, byte[], byte) - Method in class lejos.nxt.remote.NXTCommand
Used to request data from an Inter-Integrated Circuit (I2C) sensor (the ultrasound sensor) via the Low Speed (LS) data port.
LUDecomposition - Class in lejos.util
LU Decomposition.
LUDecomposition(Matrix) - Constructor for class lejos.util.LUDecomposition
LU Decomposition

M

MAGENTA - Static variable in class lejos.robotics.Color
 
main(String[]) - Static method in class lejos.util.jni.OSInfo
Deprecated. don't call it, only used for debugging/user assistance
makeLeftOrth() - Method in class lejos.geom.Point
 
makeRightOrth() - Method in class lejos.geom.Point
 
map - Variable in class lejos.pc.comm.MapPanel
 
MapPanel - Class in lejos.pc.comm
 
MapPanel(LineMap, float, float, float) - Constructor for class lejos.pc.comm.MapPanel
 
Matrix - Class in lejos.util
 
Matrix(int, int) - Constructor for class lejos.util.Matrix
Construct an m-by-n matrix of zeros.
Matrix(int, int, double) - Constructor for class lejos.util.Matrix
Construct an m-by-n constant matrix.
Matrix(double[][]) - Constructor for class lejos.util.Matrix
Construct a matrix from a 2-D array.
Matrix(double[][], int, int) - Constructor for class lejos.util.Matrix
Construct a matrix quickly without checking arguments.
Matrix(double[], int) - Constructor for class lejos.util.Matrix
Construct a matrix from a one-dimensional packed array
MAX_AD_RAW - Static variable in interface lejos.nxt.SensorConstants
MAX value returned as a RAW sensor reading for standard A/D sensors
MAX_FILENAMELENGTH - Static variable in class lejos.nxt.remote.NXTCommand
 
MAX_POWER - Static variable in interface lejos.nxt.BasicMotorPort
Maximum power setting = 100%
MAX_RELIABLE_RANGE_READING - Variable in class lejos.robotics.FixedRangeScanner
 
MAX_RELIABLE_RANGE_READING - Variable in class lejos.robotics.RotatingRangeScanner
 
MAX_TYPE - Static variable in interface lejos.nxt.SensorConstants
 
maxHeadingError - Variable in class lejos.robotics.navigation.WayPoint
 
maxIterations - Static variable in class lejos.robotics.localization.MCLParticleSet
 
maxPositionError - Variable in class lejos.robotics.navigation.WayPoint
 
mcl - Variable in class lejos.pc.comm.MCLPanel
 
MCLPanel - Class in lejos.pc.comm
 
MCLPanel(LineMap, float, float, float, MCLPoseProvider, float) - Constructor for class lejos.pc.comm.MCLPanel
 
MCLParticle - Class in lejos.robotics.localization
Represents a particle for the particle filtering algorithm.
MCLParticle(Pose) - Constructor for class lejos.robotics.localization.MCLParticle
Create a particle with a specific pose
MCLParticleSet - Class in lejos.robotics.localization
Represents a particle set for the particle filtering algorithm.
MCLParticleSet(RangeMap, int, int) - Constructor for class lejos.robotics.localization.MCLParticleSet
Create a set of particles randomly distributed within the given map.
MCLParticleSet(RangeMap, int, int, RangeReadings, float, float) - Constructor for class lejos.robotics.localization.MCLParticleSet
Generates a set of particles within the map that have a minimum weight as as calculated from the particle pose, the range readings and the map.
MCLParticleSet(RangeMap, int, Pose, float, float) - Constructor for class lejos.robotics.localization.MCLParticleSet
Generates a circular cloud of particles centered on initialPose with random normal radius and angle, and random normal heading.
MCLPoseProvider - Class in lejos.robotics.localization
Maintains an estimate of the robot pose using sensor data.
MCLPoseProvider(MoveProvider, RangeScanner, RangeMap, int, int) - Constructor for class lejos.robotics.localization.MCLPoseProvider
Allocates a new MCLPoseProvider.
MESSAGE_READ - Static variable in interface lejos.nxt.remote.NXTProtocol
 
MESSAGE_WRITE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
messageRead(byte, byte, boolean) - Method in class lejos.nxt.remote.NXTCommand
 
messageWrite(byte[], byte) - Method in class lejos.nxt.remote.NXTCommand
Sends a message to an inbox on the NXT for storage(?) For future reference, message size must be capped at 59 for USB.
MIN_TYPE - Static variable in interface lejos.nxt.SensorConstants
 
minus(Matrix) - Method in class lejos.util.Matrix
C = A - B
minusEquals(Matrix) - Method in class lejos.util.Matrix
A = A - B
MMX_MOTOR_1 - Static variable in class lejos.nxt.addon.NXTMMX
NXTMMX Motor 1.
MMX_MOTOR_2 - Static variable in class lejos.nxt.addon.NXTMMX
NXTMMX Motor 2.
MMXRegulatedMotor - Class in lejos.nxt.addon
Supports Mindsensors NXTMMX motor multiplexer.
MMXRegulatedMotor(NXTMMX, int) - Constructor for class lejos.nxt.addon.MMXRegulatedMotor
Create an instance of a MMXRegulatedMotor.
mode - Variable in class lejos.nxt.BasicMotor
 
mode - Variable in class lejos.nxt.remote.OutputState
 
MODE_ANGLESTEP - Static variable in interface lejos.nxt.SensorConstants
 
MODE_BOOLEAN - Static variable in interface lejos.nxt.SensorConstants
 
MODE_CAPTURE - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_CELSIUS - Static variable in interface lejos.nxt.SensorConstants
 
MODE_CONTINUOUS - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_FARENHEIT - Static variable in interface lejos.nxt.SensorConstants
 
MODE_OFF - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_PCTFULLSCALE - Static variable in interface lejos.nxt.SensorConstants
 
MODE_PERIODCOUNTER - Static variable in interface lejos.nxt.SensorConstants
 
MODE_PING - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_RAW - Static variable in interface lejos.nxt.SensorConstants
 
MODE_RESET - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_TRANSITIONCNT - Static variable in interface lejos.nxt.SensorConstants
 
MODEMASK - Static variable in interface lejos.nxt.remote.NXTProtocol
 
MODULE_NOT_FOUND - Static variable in interface lejos.nxt.remote.ErrorMessages
 
Motor - Class in lejos.nxt
Motor class.
Motor() - Constructor for class lejos.nxt.Motor
 
MOTOR_A_FORWARD - Static variable in class lejos.nxt.addon.RCXLink
 
MOTOR_A_REVERSED - Static variable in class lejos.nxt.addon.RCXLink
 
MOTOR_B_FORWARD - Static variable in class lejos.nxt.addon.RCXLink
 
MOTOR_B_REVERSED - Static variable in class lejos.nxt.addon.RCXLink
 
MOTOR_C_FORWARD - Static variable in class lejos.nxt.addon.RCXLink
 
MOTOR_C_REVERSED - Static variable in class lejos.nxt.addon.RCXLink
 
MOTOR_CH1_A_BRAKE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH1_A_FLOAT - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH1_A_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH1_A_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH1_B_BRAKE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH1_B_FLOAT - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH1_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH1_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH2_A_BRAKE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH2_A_FLOAT - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH2_A_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH2_A_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH2_B_BRAKE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH2_B_FLOAT - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH2_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH2_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH3_A_BRAKE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH3_A_FLOAT - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH3_A_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH3_A_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH3_B_BRAKE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH3_B_FLOAT - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH3_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH3_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH4_A_BRAKE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH4_A_FLOAT - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH4_A_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH4_A_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH4_B_BRAKE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH4_B_FLOAT - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH4_B_FORWARD - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_CH4_B_REVERSE - Static variable in class lejos.nxt.addon.PFLink
 
MOTOR_RUN_STATE_IDLE - Static variable in interface lejos.nxt.remote.NXTProtocol
Output will be idle
MOTOR_RUN_STATE_RAMPDOWN - Static variable in interface lejos.nxt.remote.NXTProtocol
Output will ramp-down
MOTOR_RUN_STATE_RAMPUP - Static variable in interface lejos.nxt.remote.NXTProtocol
Output will ramp-up
MOTOR_RUN_STATE_RUNNING - Static variable in interface lejos.nxt.remote.NXTProtocol
Output will be running
MOTORON - Static variable in interface lejos.nxt.remote.NXTProtocol
Turn on the specified motor
MotorPort - Class in lejos.nxt
This version of the MotorPort class supports a motor connected to a remote NXT
MotorPort(int) - Constructor for class lejos.nxt.MotorPort
 
mouseClicked(MouseEvent) - Method in class lejos.pc.comm.RemoteFrame
Find the closest particle to the mouse click
mouseEntered(MouseEvent) - Method in class lejos.pc.comm.RemoteFrame
 
mouseExited(MouseEvent) - Method in class lejos.pc.comm.RemoteFrame
 
mousePressed(MouseEvent) - Method in class lejos.pc.comm.RemoteFrame
 
mouseReleased(MouseEvent) - Method in class lejos.pc.comm.RemoteFrame
 
Move - Class in lejos.robotics.navigation
Models a movement performed by a pilot
Move(float, float, boolean) - Constructor for class lejos.robotics.navigation.Move
Create a movement object to record a movement made by a pilot.
Move(Move.MoveType, float, float, float, float, boolean) - Constructor for class lejos.robotics.navigation.Move
Create a movement object to record a movement made by a pilot.
Move(Move.MoveType, float, float, boolean) - Constructor for class lejos.robotics.navigation.Move
Create a movement object to record a movement made by a pilot.
Move(boolean, float, float) - Constructor for class lejos.robotics.navigation.Move
Alternate constructor that uses angle and turn radius instead.
Move.MoveType - Enum in lejos.robotics.navigation
The type of movement made in sufficient detail to allow errors in the movement to be modeled.
MoveController - Interface in lejos.robotics.navigation
 
MoveListener - Interface in lejos.robotics.navigation
Any class that wants to be updated automatically by a MoveProvider should implement this interface.
movementStart(boolean) - Method in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this method will be private in NXJ version 1.0 when the CompassPilot is removed.
MoveProvider - Interface in lejos.robotics.navigation
Should be implemented by a Pilot that provides a partial movement to a pose when requested.
moveStarted(Move, MoveProvider) - Method in class lejos.robotics.localization.MCLPoseProvider
Required by MoveListener interface; does nothing
moveStarted(Move, MoveProvider) - Method in class lejos.robotics.localization.OdometryPoseProvider
called by a MoveProvider when movement starts
moveStarted(Move, MoveProvider) - Method in interface lejos.robotics.navigation.MoveListener
Called when a Move Provider starts a move
moveStopped(Move, MoveProvider) - Method in class lejos.robotics.localization.MCLPoseProvider
Required by MoveListener interface.
moveStopped(Move, MoveProvider) - Method in class lejos.robotics.localization.OdometryPoseProvider
called by a MoveProvider when movement ends
moveStopped(Move, MoveProvider) - Method in interface lejos.robotics.navigation.MoveListener
Called by the movement provider when a move stops
moveTo(Point) - Method in class lejos.geom.Point
 
moveUpdate(float) - Method in class lejos.robotics.navigation.Pose
Move the specified distance in the direction of current heading.
MSC - Class in lejos.nxt.addon
This class has been designed to manage the device MSC8, Mindsensors NXT Servo which manages up to 8 RC Servos.
MSC(SensorPort) - Constructor for class lejos.nxt.addon.MSC
Constructor
MSC8_VBATT - Static variable in class lejos.nxt.addon.MSC
 
msDelay(long) - Static method in class lejos.util.Delay
Wait for the specified number of milliseconds.
MServo - Class in lejos.nxt.addon
MServo, is a abstraction to model any RC Servo (continuous and non continuous) plugged to
MServo(SensorPort, int) - Constructor for class lejos.nxt.addon.MServo
The initial Constructor.
MServo(SensorPort, int, String) - Constructor for class lejos.nxt.addon.MServo
The initial Constructor.
MServo(SensorPort, int, String, int, int) - Constructor for class lejos.nxt.addon.MServo
Constructor with the feature to set min, max and init angle
multiply(float) - Method in class lejos.geom.Point
 
multiplyBy(float) - Method in class lejos.geom.Point
 

N

name - Variable in class lejos.pc.comm.NXTInfo
Friendly name of the NXT.
NavigationMesh - Interface in lejos.robotics.pathfinding
A navigation mesh is a set of nodes covering a map area which represent branching pathways for the vehicle to move from one location to another.
NavPathController - Class in lejos.robotics.navigation
This class can cause the robot to follow a route - a sequence of WayPoint ; The way points are stored in a queue (actually, a Collection).
NavPathController(MoveController) - Constructor for class lejos.robotics.navigation.NavPathController
Can use any pilot that implements the ArcMoveController interface.
NavPathController(MoveController, PoseProvider) - Constructor for class lejos.robotics.navigation.NavPathController
Creates a PathController using a custom poseProvider, rather than the default tachometer pose provider.
NavPathController(MoveController, PoseProvider, PathFinder) - Constructor for class lejos.robotics.navigation.NavPathController
Creates a PathController which will navigate to a point via goTo() using a PathFinder to provide assistance to create a path.
NavPathController.Nav - Class in lejos.robotics.navigation
This inner class runs the thread that processes the waypoint queue
NavPathController.Nav() - Constructor for class lejos.robotics.navigation.NavPathController.Nav
 
neighbors() - Method in class lejos.robotics.pathfinding.Node
Indicates the number of neighbors (nodes connected to this node).
nextWaypoint(WayPoint) - Method in interface lejos.robotics.navigation.WayPointListener
Called when the class providing waypoints has another waypoint to report.
NO_ACTIVE_PROGRAM - Static variable in interface lejos.nxt.remote.ErrorMessages
 
NO_FREE_MEMORY_IN_COMMUNICATION_BUFFER - Static variable in interface lejos.nxt.remote.ErrorMessages
 
NO_LINEAR_SPACE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
NO_MORE_FILES - Static variable in interface lejos.nxt.remote.ErrorMessages
 
NO_MORE_HANDLES - Static variable in interface lejos.nxt.remote.ErrorMessages
 
NO_OF_SENSOR_TYPES - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NO_SENSOR - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NO_SORTING - Static variable in class lejos.nxt.addon.NXTCam
Used by sortBy() to choose no sorting of detected objects.
NO_SPACE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
NO_WRITE_BUFFERS - Static variable in interface lejos.nxt.remote.ErrorMessages
 
noAngle - Static variable in class lejos.nxt.addon.IRSeekerV2
 
Node - Class in lejos.robotics.pathfinding
This class represents a Node which can be connected to other neighboring nodes.
Node(float, float) - Constructor for class lejos.robotics.pathfinding.Node
Creates a new instance of a node.
NodePathFinder - Class in lejos.robotics.pathfinding
This path finder class uses one of the common search algorithms (e.g.
NodePathFinder(SearchAlgorithm, NavigationMesh) - Constructor for class lejos.robotics.pathfinding.NodePathFinder
Instantiates a NodePathFinder object using a specified algorithm.
NONE - Static variable in class lejos.robotics.Color
 
norm1() - Method in class lejos.util.Matrix
One norm
normalize() - Method in class lejos.geom.Point
 
normalize(float) - Method in class lejos.robotics.navigation.CompassPilot
Deprecated.  
normalizedADValue - Variable in class lejos.nxt.remote.InputValues
The normalized value from the Analog to Digital (AD) converter.
normF() - Method in class lejos.util.Matrix
Frobenius norm
normInf() - Method in class lejos.util.Matrix
Infinity norm
NOT_A_LINEAR_FILE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
notifyListeners(Feature) - Method in class lejos.robotics.objectdetection.FeatureDetectorAdapter
 
notifyListeners(Feature) - Method in class lejos.robotics.objectdetection.TouchFeatureDetector
 
NR_RANGE_LONG - Static variable in class lejos.nxt.addon.PFLink
 
NR_RANGE_SHORT - Static variable in class lejos.nxt.addon.PFLink
 
nsDelay(long) - Static method in class lejos.util.Delay
Wait for the specified number of nanoseconds.
NUMBER_OF_SENSORS - Static variable in class lejos.nxt.addon.TouchMUX
number of touch sensors supported by this device
numParticles - Variable in class lejos.pc.comm.MCLPanel
 
numParticles() - Method in class lejos.robotics.localization.MCLParticleSet
Return the number of particles in the set
NXJ_DEFRAG - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_DISCONNECT - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_FIND_FIRST - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_FIND_NEXT - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_PACKET_MODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXT - Class in lejos.nxt
Abstraction for the local NXT device.
NXT() - Constructor for class lejos.nxt.NXT
 
NXTCam - Class in lejos.nxt.addon
Mindsensors NXTCam.
NXTCam(I2CPort, int) - Constructor for class lejos.nxt.addon.NXTCam
 
NXTCam(I2CPort) - Constructor for class lejos.nxt.addon.NXTCam
 
NXTComm - Interface in lejos.pc.comm
Interface that all NXTComm implementation classes must implement for low-level communication with the NXT.
NXTCommand - Class in lejos.nxt.remote
Sends LCP requests to the NXT and receives replies.
NXTCommand() - Constructor for class lejos.nxt.remote.NXTCommand
Create a NXTCommand object.
NXTCommandConnector - Class in lejos.pc.comm
Used by remote execution leJOS API classes to create a connection to a NXTCommand (LCP) connection to the NXT.
NXTCommandConnector() - Constructor for class lejos.pc.comm.NXTCommandConnector
 
NXTCommBluecove - Class in lejos.pc.comm
Implementation of NXTComm using the Bluecove libraries on Microsoft Windows.
NXTCommBluecove() - Constructor for class lejos.pc.comm.NXTCommBluecove
 
NXTCommBluez - Class in lejos.pc.comm
Implementation of NXTComm using the the jbluez library on Linux or Unix systems.
NXTCommBluez() - Constructor for class lejos.pc.comm.NXTCommBluez
 
NXTCommException - Exception in lejos.pc.comm
An exception thrown by a NXTComm implementation.
NXTCommException() - Constructor for exception lejos.pc.comm.NXTCommException
 
NXTCommException(String, Throwable) - Constructor for exception lejos.pc.comm.NXTCommException
 
NXTCommException(String) - Constructor for exception lejos.pc.comm.NXTCommException
 
NXTCommException(Throwable) - Constructor for exception lejos.pc.comm.NXTCommException
 
NXTCommFactory - Class in lejos.pc.comm
Creates a version of NTComm appropriate to the OS in use and protocol (Bluetooth or USB) that is requested.
NXTCommFactory() - Constructor for class lejos.pc.comm.NXTCommFactory
 
NXTCommFantom - Class in lejos.pc.comm
Implementation of NXTComm using the the LEGO Fantom API.
NXTCommFantom() - Constructor for class lejos.pc.comm.NXTCommFantom
 
NXTCommInputStream - Class in lejos.pc.comm
Implementation of InputStream over NXTComm using Bluetooth.
NXTCommInputStream(NXTComm) - Constructor for class lejos.pc.comm.NXTCommInputStream
 
NXTCommLibnxt - Class in lejos.pc.comm
Implementation of NXTComm over USB using libnxt.
NXTCommLibnxt() - Constructor for class lejos.pc.comm.NXTCommLibnxt
 
NXTCommLoggable - Class in lejos.pc.comm
Abstract class that allows inheriting class to register and use log listeners.
NXTCommLoggable() - Constructor for class lejos.pc.comm.NXTCommLoggable
 
NXTCommLogListener - Interface in lejos.pc.comm
Listener for log events
NXTCommOutputStream - Class in lejos.pc.comm
Implementation of OutputStream over NXTComm using Bluetooth.
NXTCommOutputStream(NXTComm) - Constructor for class lejos.pc.comm.NXTCommOutputStream
 
NXTCommRequest - Interface in lejos.nxt.remote
Interface that all NXTComm implementation classes must implement for low-level communication with the NXT.
NXTCommUSB - Class in lejos.pc.comm
Base Implementation of NXTComm for USB This module implements two types of I/O over USB.
NXTCommUSB() - Constructor for class lejos.pc.comm.NXTCommUSB
 
NXTConnectionManager - Class in lejos.pc.comm
 
NXTConnectionManager() - Constructor for class lejos.pc.comm.NXTConnectionManager
 
NXTConnectionState - Enum in lejos.pc.comm
 
NXTConnector - Class in lejos.pc.comm
Connects to a NXT using Bluetooth or USB (or either) and supplies input and output data streams.
NXTConnector() - Constructor for class lejos.pc.comm.NXTConnector
 
NXTe - Class in lejos.nxt.addon
Abstraction for a Lattebox NXT Extension Kit with Lattebox 10-Axis Servo Kit http://www.lattebox.com UML: http://www.juanantonio.info/p_research/robotics/lejos/nxj/lattebox/LatteboxNXTeKit.png
NXTe(SensorPort) - Constructor for class lejos.nxt.addon.NXTe
Constructor
NXTE_ADDRESS - Static variable in class lejos.nxt.addon.NXTe
 
NXTInfo - Class in lejos.pc.comm
Structure containing information about a specific NXT and the potential connections to it.
NXTInfo() - Constructor for class lejos.pc.comm.NXTInfo
 
NXTInfo(int, String, String) - Constructor for class lejos.pc.comm.NXTInfo
Create a NXTInfo that is used to connect to a NXT via Bluetooth using the Bluetooth address.
NXTInfo(NXTInfo) - Constructor for class lejos.pc.comm.NXTInfo
copy constructor
NXTLineLeader - Class in lejos.nxt.addon
This class manages the sensor NXT Line Leader from Mindsensors.
NXTLineLeader(I2CPort, int) - Constructor for class lejos.nxt.addon.NXTLineLeader
Constructor
NXTLineLeader(I2CPort) - Constructor for class lejos.nxt.addon.NXTLineLeader
Constructor
NXTLineLeader.Command - Enum in lejos.nxt.addon
 
NXTLineLeader.LineColor - Enum in lejos.nxt.addon
Color selector for white reading limit
NXTMMX - Class in lejos.nxt.addon
Supports the Mindsensors NXTMMX motor multiplexor.
NXTMMX(SensorPort, int) - Constructor for class lejos.nxt.addon.NXTMMX
Constructor for the NXTMMX
NXTMMX(SensorPort) - Constructor for class lejos.nxt.addon.NXTMMX
Constructor for the NXTMMX
NXTMMXMotor - Class in lejos.nxt.addon
Supports Mindsensors NXTMMX.
NXTMMXMotor(NXTMMX, int) - Constructor for class lejos.nxt.addon.NXTMMXMotor
Constructor, you don't have to worry about this its called two times by the constructor in the NXTMMX class to create each motor instance.
NXTname - Variable in class lejos.nxt.remote.DeviceInfo
 
nxtName - Variable in class lejos.pc.comm.RemoteFrame
 
NXTProtocol - Interface in lejos.nxt.remote
LEGO Communication Protocol constants.
NXTSamba - Class in lejos.pc.comm
Implements a sub-set of the Atmel SAM-BA download protocol.
NXTSamba() - Constructor for class lejos.pc.comm.NXTSamba
 
NXTSERVO_ADDRESS - Static variable in class lejos.nxt.addon.MSC
 

O

OBJECT_TRACKING - Static variable in class lejos.nxt.addon.NXTCam
Used by setTrackingMode() to choose object tracking.
OdometryPoseProvider - Class in lejos.robotics.localization
A PoseProvider keeps track of the robot Pose.
OdometryPoseProvider(MoveProvider) - Constructor for class lejos.robotics.localization.OdometryPoseProvider
Allocates a new OdometryPoseProivder and registers it with the MovePovider as a listener.
off() - Method in class lejos.nxt.UltrasonicSensor
Turn off the sensor.
ONE_ROTATION - Static variable in class lejos.nxt.addon.RCXRotationSensor
The incremental count for one whole rotation (360 degrees).
Opcode - Interface in lejos.nxt.rcxcomm
Opcode constants.
OPCODE_ABSOLUTE_VALUE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_ABSOLUTE_VALUE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_ADD_TO_VARIABLE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_ADD_TO_VARIABLE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_ALIVE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_ALIVE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_AND_VARIABLE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_AND_VARIABLE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_BRANCH_ALWAYS_FAR - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_BRANCH_ALWAYS_NEAR - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_CALL_SUBROUTINE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_CLEAR_MESSAGE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_CLEAR_SENSOR_VALUE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_CLEAR_SENSOR_VALUE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_CLEAR_TIMER - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_CLEAR_TIMER_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DATALOG_NEXT - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DATALOG_NEXT_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DECREMENT_LOOP_COUNTER_FAR - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DECREMENT_LOOP_COUNTER_NEAR - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_ALL_SUBROUTINES - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_ALL_SUBROUTINES_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_ALL_TASKS - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_ALL_TASKS_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_FIRMWARE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_FIRMWARE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_SUBROUTINE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_SUBROUTINE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_TASK - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DELETE_TASK_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DIVIDE_VARIABLE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_DIVIDE_VARIABLE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_GET_BATTERY_POWER - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_GET_BATTERY_POWER_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_GET_MEMORY_MAP - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_GET_MEMORY_MAP_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_GET_VALUE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_GET_VALUE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_GET_VERSIONS - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_GET_VERSIONS_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_MASK - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_MULTIPLY_VARIABLE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_MULTIPLY_VARIABLE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_OR_VARIABLE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_OR_VARIABLE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_PLAY_SOUND_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_PLAY_TONE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_PLAY_TONE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_POWER_OFF - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_POWER_OFF_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_REMOTE_COMMAND - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SEND_MESSAGE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_DATALOG_SIZE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_DATALOG_SIZE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_DISPLAY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_DISPLAY_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_LOOP_COUNTER - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_MESSAGE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_MOTOR_DIRECTION - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_MOTOR_DIRECTION_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_MOTOR_ON_OFF - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_MOTOR_ON_OFF_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_MOTOR_POWER - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_MOTOR_POWER_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_POWER_DOWN_DELAY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_POWER_DOWN_DELAY_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_PROGRAM_NUMBER - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_PROGRAM_NUMBER_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_SENSOR_MODE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_SENSOR_MODE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_SENSOR_TYPE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_SENSOR_TYPE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_TIME - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_TIME_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_TRANSMITTER_RANGE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_TRANSMITTER_RANGE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_VARIABLE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SET_VARIABLE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SIGN_VARIABLE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SIGN_VARIABLE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_START_FIRMWARE_DOWNLOAD - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_START_FIRMWARE_DOWNLOAD_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_START_SUBROUTINE_DOWNLOAD - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_START_SUBROUTINE_DOWNLOAD_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_START_TASK - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_START_TASK_DOWNLOAD - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_START_TASK_DOWNLOAD_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_START_TASK_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_STOP_ALL_TASKS - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_STOP_ALL_TASKS_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_STOP_TASK - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_STOP_TASK_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SUBTRACT_FROM_VARIABLE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_SUBTRACT_FROM_VARIABLE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_TEST_AND_BRANCH_FAR - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_TEST_AND_BRANCH_NEAR - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_TRANSFER_DATA - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_TRANSFER_DATA_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_UNLOCK_FIRMWARE - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_UNLOCK_FIRMWARE_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_UPLOAD_DATALOG - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_UPLOAD_DATALOG_REPLY - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
OPCODE_WAIT - Static variable in interface lejos.nxt.rcxcomm.Opcode
 
open(byte, byte) - Method in class lejos.nxt.rcxcomm.PacketHandler
Set the source and destination for this connection.
open(NXTInfo, int) - Method in interface lejos.pc.comm.NXTComm
Connect to a NXT found by a search or created from mname and address.
open(NXTInfo) - Method in interface lejos.pc.comm.NXTComm
Connect to a NXT found by a search or created from mname and address.
open() - Static method in class lejos.pc.comm.NXTCommandConnector
Open any available NXT.
open(NXTInfo, int) - Method in class lejos.pc.comm.NXTCommBluecove
 
open(NXTInfo) - Method in class lejos.pc.comm.NXTCommBluecove
 
open(NXTInfo, int) - Method in class lejos.pc.comm.NXTCommBluez
 
open(NXTInfo) - Method in class lejos.pc.comm.NXTCommBluez
 
open(NXTInfo, int) - Method in class lejos.pc.comm.NXTCommUSB
Open a connection to the specified device, and make it available for use.
open(NXTInfo) - Method in class lejos.pc.comm.NXTCommUSB
 
open(NXTInfo) - Method in class lejos.pc.comm.NXTSamba
Open the specified USB device and check that it is in SAM-BA mode.
OPEN_APPEND_DATA - Static variable in interface lejos.nxt.remote.NXTProtocol
 
OPEN_READ - Static variable in interface lejos.nxt.remote.NXTProtocol
 
OPEN_READ_LINEAR - Static variable in interface lejos.nxt.remote.NXTProtocol
 
OPEN_WRITE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
OPEN_WRITE_DATA - Static variable in interface lejos.nxt.remote.NXTProtocol
 
OPEN_WRITE_LINEAR - Static variable in interface lejos.nxt.remote.NXTProtocol
 
openInJFrame(Container, int, int, String, Color) - Static method in class lejos.pc.comm.RemoteFrame
Create a frame to display the panel in
openRead(String) - Method in class lejos.nxt.remote.NXTCommand
Opens a file on the NXT for reading.
openWrite(String, int) - Method in class lejos.nxt.remote.NXTCommand
Opens a file on the NXT for writing.
OpticalDistanceSensor - Class in lejos.nxt.addon
Supports Mindsensors DIST-Nx series of Optical Distance Sensor.
This sensor is used for greater precision than the Ultrasonic Sensor.
OpticalDistanceSensor(I2CPort) - Constructor for class lejos.nxt.addon.OpticalDistanceSensor
 
OpticalDistanceSensor(I2CPort, int) - Constructor for class lejos.nxt.addon.OpticalDistanceSensor
 
ORANGE - Static variable in class lejos.robotics.Color
 
OS_LINUX - Static variable in class lejos.util.jni.OSInfo
 
OS_MACOS - Static variable in class lejos.util.jni.OSInfo
 
OS_MACOSX - Static variable in class lejos.util.jni.OSInfo
 
OS_SOLARIS - Static variable in class lejos.util.jni.OSInfo
 
OS_WINDOWS - Static variable in class lejos.util.jni.OSInfo
 
OS_WINDOWS_CE - Static variable in class lejos.util.jni.OSInfo
 
OSInfo - Class in lejos.util.jni
Performs normalization of os.name and os.arch system properties.
OSInfo() - Constructor for class lejos.util.jni.OSInfo
Creates OSInfo-Object with Infos about the current System according to the System-properties.
OSInfo(String, String, int) - Constructor for class lejos.util.jni.OSInfo
 
out - Static variable in class lejos.pc.comm.SystemContext
Deprecated.  
OUT_OF_BOUNDARY - Static variable in interface lejos.nxt.remote.ErrorMessages
 
outputPort - Variable in class lejos.nxt.remote.OutputState
 
OutputState - Class in lejos.nxt.remote
Container for holding the output state values.
OutputState(int) - Constructor for class lejos.nxt.remote.OutputState
 

P

PACKET - Static variable in interface lejos.pc.comm.NXTComm
 
PacketHandler - Class in lejos.nxt.rcxcomm
Abstract packet handler.
PacketHandler() - Constructor for class lejos.nxt.rcxcomm.PacketHandler
 
PacketHandler(PacketHandler) - Constructor for class lejos.nxt.rcxcomm.PacketHandler
 
packetHandler - Variable in class lejos.nxt.rcxcomm.RCXAbstractPort
 
PAGE_MAX - Static variable in class lejos.pc.comm.NXTSamba
 
PAGE_SIZE - Static variable in class lejos.pc.comm.NXTSamba
 
paintComponent(Graphics) - Method in class lejos.pc.comm.MapPanel
 
paintComponent(Graphics) - Method in class lejos.pc.comm.MCLPanel
Paint the map and particles
paintMap(Graphics2D) - Method in class lejos.pc.comm.MapPanel
Draw the map using Line2D objects
paintParticles(Graphics2D) - Method in class lejos.pc.comm.MCLPanel
Paint the particles
paintPose(Graphics2D, Pose) - Method in class lejos.pc.comm.MCLPanel
Paint the pose using Ellipse2D
particles - Variable in class lejos.pc.comm.MCLPanel
 
passivate() - Method in class lejos.nxt.addon.RCXLightSensor
Deprecated. Use RCXLightSensor.setFloodlight(boolean) with false instead
passivate() - Method in interface lejos.nxt.LegacySensorPort
 
passivate() - Method in class lejos.nxt.SensorPort
Passivate an RCX Light Sensor
pathComplete() - Method in interface lejos.robotics.navigation.WayPointListener
Called if/when the last Waypoint in the path has been sent.
PathController - Interface in lejos.robotics.navigation
The PathController guides a MoveController to a destination.
pathFinder - Variable in class lejos.robotics.navigation.NavPathController
 
PathFinder - Interface in lejos.robotics.pathfinding
This class creates a set of waypoints connected by straight lines that lead from one location to another without colliding with mapped geometry.
PCTFULLSCALEMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
PENDING_COMMUNICATION_TRANSACTION_IN_PROGRESS - Static variable in interface lejos.nxt.remote.ErrorMessages
 
PERIODCOUNTERMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
PERSISTENT_FILENAME - Static variable in class lejos.util.PilotProps
 
PF_BACKWARD - Static variable in class lejos.nxt.addon.IRLink
 
PF_BRAKE - Static variable in class lejos.nxt.addon.IRLink
 
PF_FLOAT - Static variable in class lejos.nxt.addon.IRLink
 
PF_FORWARD - Static variable in class lejos.nxt.addon.IRLink
 
PF_MODE_COMBO_DIRECT - Static variable in class lejos.nxt.addon.IRLink
 
PFLink - Class in lejos.nxt.addon
Class for controlling PF Motors with MindSensors NRLink-Nx
PFLink(I2CPort, int) - Constructor for class lejos.nxt.addon.PFLink
 
PFLink(I2CPort) - Constructor for class lejos.nxt.addon.PFLink
 
PFMate - Class in lejos.nxt.addon
Supports Mindsensors PF Mate
This device is used to control Lego Power Function IR receiver
PFMate(I2CPort, int) - Constructor for class lejos.nxt.addon.PFMate
Constructor takes in the sensor port and the PF channel you will be using
PFMate(I2CPort, int, int) - Constructor for class lejos.nxt.addon.PFMate
Constructor takes in the sensor port and the PF channel you will be using
PFMateMotor - Class in lejos.nxt.addon
Motor class for PFMate class
PFMotorPort - Class in lejos.nxt.addon
MotorPort for PF Motors using HiTechnic IRLink
PFMotorPort(IRLink, int, int) - Constructor for class lejos.nxt.addon.PFMotorPort
 
pilot - Variable in class lejos.robotics.FixedRangeScanner
 
PilotProps - Class in lejos.util
Configuration class for Differential Pilot.
PilotProps() - Constructor for class lejos.util.PilotProps
 
ping() - Method in class lejos.nxt.addon.RCXLink
 
ping() - Method in class lejos.nxt.UltrasonicSensor
Send a single ping.
PINK - Static variable in class lejos.robotics.Color
 
pixelsPerUnit - Variable in class lejos.pc.comm.MapPanel
 
PLAY_SOUND_FILE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
PLAY_TONE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
playSoundFile(String, boolean) - Method in class lejos.nxt.remote.NXTCommand
 
playSoundFile(String, boolean) - Static method in class lejos.nxt.Sound
Plays a sound file from the NXT.
playSoundFile(String) - Static method in class lejos.nxt.Sound
Plays a sound file once from the NXT.
playTone(int, int) - Method in class lejos.nxt.remote.NXTCommand
Plays a tone on NXT speaker.
playTone(int, int) - Static method in class lejos.nxt.Sound
 
plus(Matrix) - Method in class lejos.util.Matrix
C = A + B
plusEquals(Matrix) - Method in class lejos.util.Matrix
A = A + B
Point - Class in lejos.geom
Point with float co-ordinates for use in navigation.
Point(float, float) - Constructor for class lejos.geom.Point
 
Point(float) - Constructor for class lejos.geom.Point
 
pointAt(float, float) - Method in class lejos.geom.Point
Returns a new point at the specified distance in the direction angle from this point.
pointAt(float, float) - Method in class lejos.robotics.navigation.Pose
Returns the point at distance from the location of this pose, in the direction bearing relative to the X axis.
POLL - Static variable in interface lejos.nxt.remote.NXTProtocol
 
POLL_BUFFER - Static variable in interface lejos.nxt.remote.NXTProtocol
 
POLL_LENGTH - Static variable in interface lejos.nxt.remote.NXTProtocol
 
port - Variable in class lejos.nxt.addon.GyroSensor
The ADSensorPort passed in the constructor.
port - Variable in class lejos.nxt.addon.RCXRotationSensor
 
port - Variable in class lejos.nxt.BasicMotor
 
port - Variable in class lejos.nxt.ColorSensor
 
port - Variable in class lejos.nxt.I2CSensor
 
Pose - Class in lejos.robotics.navigation
Represents the location and heading(direction angle) of a robot.
This class includes methods for updating the Pose to in response to basic robot movements.
Pose() - Constructor for class lejos.robotics.navigation.Pose
allocate a new Pose at the origin, heading = 0:the direction the positive X axis
Pose(float, float, float) - Constructor for class lejos.robotics.navigation.Pose
Allocate a new pose at location (x,y) with specified heading in degrees.
PoseProvider - Interface in lejos.robotics.localization
Provides the coordinate and heading info via a Pose object.
poseProvider - Variable in class lejos.robotics.navigation.NavPathController
 
power - Variable in class lejos.nxt.BasicMotor
 
POWER_OFF_RCX - Static variable in class lejos.nxt.addon.RCXLink
 
powerOff() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Turns power to the sensor module off.
powerOff() - Method in class lejos.nxt.addon.RCXLink
 
powerOn() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Turns the sensor module on.
powerSetpoint - Variable in class lejos.nxt.remote.OutputState
 
powerUp(boolean) - Method in class lejos.nxt.addon.PSPNXController
 
print(PrintStream) - Method in class lejos.util.Matrix
 
printReadings() - Method in class lejos.robotics.RangeReadings
Print the range readings on standard out
processedValue() - Method in class lejos.nxt.addon.EOPD
 
project(Point, Point) - Method in class lejos.geom.Point
 
projectWith(Point) - Method in class lejos.geom.Point
 
projectWith(Point, Point) - Method in class lejos.geom.Point
 
protocol - Variable in class lejos.pc.comm.NXTInfo
The protocol used to connect to the NXT: USB or BLUETOOTH.
protocolVersion - Variable in class lejos.nxt.remote.FirmwareInfo
 
PSPNXController - Class in lejos.nxt.addon
This class allows you to use a Sony Playstation 2 controller to control your robot in conjunction with the Mindsensors.com PSP-Nx interface.
PSPNXController(SensorPort) - Constructor for class lejos.nxt.addon.PSPNXController
 
PSPNXController(SensorPort, int) - Constructor for class lejos.nxt.addon.PSPNXController
 
PWM_BRAKE - Static variable in interface lejos.nxt.BasicMotorPort
PWM Mode.
PWM_FLOAT - Static variable in interface lejos.nxt.BasicMotorPort
PWM Mode.

R

random(int, int) - Static method in class lejos.util.Matrix
Generate matrix with random elements
RandomPathFinder - Class in lejos.robotics.pathfinding
PathFinder that takes a map and a dummy set of range readings.
RandomPathFinder(RangeMap, RangeReadings) - Constructor for class lejos.robotics.pathfinding.RandomPathFinder
 
RandomSelfGeneratingNode - Class in lejos.robotics.pathfinding
This Node is able to randomly generate its own neighbors via the getNeighbors() method.
RandomSelfGeneratingNode(float, float, float, int) - Constructor for class lejos.robotics.pathfinding.RandomSelfGeneratingNode
Creates a node that will randomly generate 'connections' number of neighbors when getNeighbors() is called.
RandomSelfGeneratingNode(float, float, float, int, Node) - Constructor for class lejos.robotics.pathfinding.RandomSelfGeneratingNode
Creates a node that will randomly generate 'connections' number of neighbors when getNeighbors() is called.
range(Pose) - Method in class lejos.robotics.mapping.LineMap
Calculate the range of a robot to the nearest wall
range(Pose) - Method in interface lejos.robotics.mapping.RangeMap
The the range to the nearest wall (or other feature)
RangeFeature - Class in lejos.robotics.objectdetection
This class is a basic data container for information retrieved about an object detected by sensors.
RangeFeature(RangeReading) - Constructor for class lejos.robotics.objectdetection.RangeFeature
Creates a RangeFeature containing a single RangeReading.
RangeFeature(RangeReadings) - Constructor for class lejos.robotics.objectdetection.RangeFeature
Creates a RangeFeature containing multiple RangeReadings.
RangeFeatureDetector - Class in lejos.robotics.objectdetection
The RangeFeatureDetector used a RangeFinder to locate objects (known as features when mapping).
RangeFeatureDetector(RangeFinder, float, int) - Constructor for class lejos.robotics.objectdetection.RangeFeatureDetector
This constructor allows you to specify the sensor, the maximum distance to report a detection, and the delay between scanning the sensor.
RangeFeatureDetector(RangeFinder, float, int, double) - Constructor for class lejos.robotics.objectdetection.RangeFeatureDetector
This constructor allows you to specify the sensor, the maximum distance to report a detection, the delay between scanning the sensor, and the angle the sensor is pointed.
rangeFinder - Variable in class lejos.robotics.FixedRangeScanner
 
RangeFinder - Interface in lejos.robotics
Abstraction for a range finder sensor that returns the distance to the nearest object
rangeFinder - Variable in class lejos.robotics.RotatingRangeScanner
 
RangeMap - Interface in lejos.robotics.mapping
The RangeMap interface supports determining the range to a feature on the map (such as a wall), from an object with a specific pose.
RangeReading - Class in lejos.robotics
Represent a single range reading
RangeReading(float, float) - Constructor for class lejos.robotics.RangeReading
Create the reading
RangeReadings - Class in lejos.robotics
Represents a set of range readings.
RangeReadings(int) - Constructor for class lejos.robotics.RangeReadings
 
RangeScanner - Interface in lejos.robotics
Abstraction for a single range scanning sensor, rotating platform with a range finder, or a complete robot, that obtains a set of range readings at a set of angles to# the robot's heading.
RAW - Static variable in interface lejos.pc.comm.NXTComm
 
rawADValue - Variable in class lejos.nxt.remote.InputValues
The raw value from the Analog to Digital (AD) converter.
RAWMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
rcSocketRecv(int) - Method in class lejos.pc.comm.NXTCommBluez
 
rcSocketSend(int, byte[]) - Method in class lejos.pc.comm.NXTCommBluez
 
RCX_REMOTE_A_BWD - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_A_FWD - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_B_BWD - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_B_FWD - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_BEEP - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_C_BWD - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_C_FWD - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_MSG1 - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_MSG2 - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_MSG3 - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_P1 - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_P2 - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_P3 - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_P4 - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_P5 - Static variable in class lejos.nxt.addon.IRLink
 
RCX_REMOTE_STOP - Static variable in class lejos.nxt.addon.IRLink
 
RCXAbstractPort - Class in lejos.nxt.rcxcomm
RCXAbstractPort provides an interface similar to java.net.Socket Adapted from original code created by the LEGO3 Team at DTU-IAU RCXAbstractPort implements input and output stream handling and input buffering.
RCXAbstractPort(PacketHandler) - Constructor for class lejos.nxt.rcxcomm.RCXAbstractPort
Constructor for the RCXAbstractPort.
RCXLightSensor - Class in lejos.nxt.addon
This class is used to obtain readings from a legacy RCX light sensor, using an adapter cable to connect it to the NXT brick.
RCXLightSensor(LegacySensorPort) - Constructor for class lejos.nxt.addon.RCXLightSensor
Create an RCX light sensor object attached to the specified port.
RCXLink - Class in lejos.nxt.addon
Supports Mindsensors NRLink RCX IR adapter.
RCXLink(I2CPort) - Constructor for class lejos.nxt.addon.RCXLink
 
RCXMotor - Class in lejos.nxt.addon
Abstraction for an RCX motor.
RCXMotor(BasicMotorPort) - Constructor for class lejos.nxt.addon.RCXMotor
 
RCXMotorMultiplexer - Class in lejos.nxt.addon
Supports the mindsensors RCX Motor Multiplexer
RCXMotorMultiplexer(I2CPort) - Constructor for class lejos.nxt.addon.RCXMotorMultiplexer
 
RCXMotorMultiplexer(I2CPort, int) - Constructor for class lejos.nxt.addon.RCXMotorMultiplexer
 
RCXPlexedMotorPort - Class in lejos.nxt.addon
Supports a motor connected to the Mindsensors RCX Motor Multiplexer
RCXPlexedMotorPort(RCXMotorMultiplexer, int) - Constructor for class lejos.nxt.addon.RCXPlexedMotorPort
 
RCXPort - Class in lejos.nxt.rcxcomm
RCXPort provides an interface similar to java.net.Socket Adapted from original code created by the LEGO3 Team at DTU-IAU Uses Reliable low-level comms for communication.
RCXPort(SensorPort) - Constructor for class lejos.nxt.rcxcomm.RCXPort
 
RCXRemoteMotorPort - Class in lejos.nxt.addon
Supports a motor connected to a remote RCX via a mindsensord NRLink adapter
RCXRemoteMotorPort(RCXLink, int) - Constructor for class lejos.nxt.addon.RCXRemoteMotorPort
 
RCXRotationSensor - Class in lejos.nxt.addon
Provide access to the Lego RCX Rotation Sensor.
RCXRotationSensor(LegacySensorPort) - Constructor for class lejos.nxt.addon.RCXRotationSensor
Create an RCX rotation sensor object attached to the specified port.
RCXRotationSensor.Reader - Class in lejos.nxt.addon
 
RCXRotationSensor.Reader() - Constructor for class lejos.nxt.addon.RCXRotationSensor.Reader
 
RCXSensorMultiplexer - Class in lejos.nxt.addon
Supports Mindsensors RXMux
This sensor allows you to connect up to four RCX type sensors toa single port.
RCXSensorMultiplexer(I2CPort) - Constructor for class lejos.nxt.addon.RCXSensorMultiplexer
 
RCXSensorMultiplexer(I2CPort, int) - Constructor for class lejos.nxt.addon.RCXSensorMultiplexer
 
RCXTemperatureSensor - Class in lejos.nxt.addon
Abstraction for an RCX temperature sensor.
RCXTemperatureSensor(LegacySensorPort) - Constructor for class lejos.nxt.addon.RCXTemperatureSensor
Create an RCX temperature sensor object attached to the specified port.
read() - Static method in class lejos.nxt.rcxcomm.LLC
read a single byte, if available
READ - Static variable in interface lejos.nxt.remote.NXTProtocol
 
read() - Method in interface lejos.pc.comm.NXTComm
Read data from a NXT that has an open connection.
read() - Method in class lejos.pc.comm.NXTCommBluecove
 
read() - Method in class lejos.pc.comm.NXTCommBluez
 
read(byte[], int, int) - Method in class lejos.pc.comm.NXTCommInputStream
 
read() - Method in class lejos.pc.comm.NXTCommInputStream
Returns one byte as an integer between 0 and 255.
read() - Method in class lejos.pc.comm.NXTCommUSB
Read bytes from the device
readAllData() - Method in class lejos.nxt.addon.CruizcoreGyro
Read all data from the sensor and save values in the private properties of the class.
readBooleanValue() - Method in interface lejos.nxt.ADSensorPort
 
readBooleanValue() - Method in class lejos.nxt.SensorPort
Reads the boolean value of the sensor.
readBytes(byte[]) - Method in class lejos.nxt.addon.RCXLink
 
readBytes(int, byte[], int, int) - Method in class lejos.pc.comm.NXTSamba
Read a 32 bit word from the specified address.
reader - Variable in class lejos.nxt.addon.RCXRotationSensor
 
readFile(byte, int) - Method in class lejos.nxt.remote.NXTCommand
Returns requested number of bytes from a file.
readHalfword(int) - Method in class lejos.pc.comm.NXTSamba
Read a 16 bit halfword from the specified address.
readings - Variable in class lejos.robotics.FixedRangeScanner
 
readings - Variable in class lejos.robotics.RotatingRangeScanner
 
readLineMap() - Method in class lejos.robotics.mapping.ShapefileLoader
Retrieves a LineMap object from the Shapefile input stream.
readNormalizedValue() - Method in class lejos.nxt.LightSensor
Get the normalized light reading
readNormalizedValue() - Method in class lejos.nxt.SensorPort
Reads the normalized value of the sensor.
readOctet(int) - Method in class lejos.pc.comm.NXTSamba
Read a 8 bit octet from the specified address.
readPacket(byte[]) - Static method in class lejos.nxt.rcxcomm.Serial
Read an assembled packet.
readPage(int, byte[], int) - Method in class lejos.pc.comm.NXTSamba
Read a single page from flash memory.
readPages(int, byte[], int, int) - Method in class lejos.pc.comm.NXTSamba
Read a series of pages from flash memory.
readRawValue() - Method in class lejos.nxt.addon.EOPD
 
readRawValue() - Method in interface lejos.nxt.ADSensorPort
 
readRawValue() - Method in class lejos.nxt.SensorPort
Reads the raw value of the sensor.
readRawValues(int[]) - Method in class lejos.nxt.SensorPort
Return a variable number of raw sensor values NOTE: Currently there is no way to return multiple results from a remote sensor, so we return an error.
readSensors() - Method in class lejos.nxt.addon.TouchMUX
Read the touch multiplexer and return a bit mask showing which sensors are currently pressed.
readTransponder(boolean) - Method in class lejos.nxt.addon.RFIDSensor
Read a transponder id.
readTransponderAsLong(boolean) - Method in class lejos.nxt.addon.RFIDSensor
 
readValue() - Method in class lejos.nxt.addon.GyroSensor
Read the gyro raw value and return with offset applied.
readValue() - Method in class lejos.nxt.addon.RCXLightSensor
Deprecated. Use RCXLightSensor.getLightValue() instead
readValue() - Method in class lejos.nxt.addon.RCXTemperatureSensor
Read the current sensor value.
readValue(int) - Method in class lejos.nxt.addon.SensorMux
Method used to receive data from a Sound Sensor
readValue() - Method in interface lejos.nxt.ADSensorPort
 
readValue() - Method in class lejos.nxt.LightSensor
Get the light reading
readValue() - Method in class lejos.nxt.SensorPort
Returns scaled value, depending on mode of sensor.
readValue() - Method in class lejos.nxt.SoundSensor
Read the current sensor value.
readValues(int[]) - Method in class lejos.nxt.SensorPort
Return a variable number of sensor values.
readWord(int) - Method in class lejos.pc.comm.NXTSamba
Read a 32 bit word from the specified address.
reboot() - Method in class lejos.pc.comm.NXTSamba
 
recalibrateOffset() - Method in class lejos.nxt.addon.GyroSensor
Samples the stationary (make sure it is) Gyro Sensor to determine the offset.
recalibrateOffset() - Method in interface lejos.robotics.Gyroscope
Implementor must calculate and set the offset/bias value for use in getAngularVelocity().
receive() - Static method in class lejos.nxt.rcxcomm.LLC
wait a little while for a byte to become available
receiveAck(byte[]) - Method in class lejos.nxt.rcxcomm.LLCHandler
Receive an ack.
receiveAck(byte[]) - Method in class lejos.nxt.rcxcomm.PacketHandler
 
receiveMessage(int, int, boolean) - Static method in class lejos.nxt.Inbox
 
receivePacket(byte[]) - Method in class lejos.nxt.rcxcomm.LLCHandler
Receive a packet.
receivePacket(byte[]) - Method in class lejos.nxt.rcxcomm.LLCReliableHandler
Receive a packet.
receivePacket(byte[]) - Method in class lejos.nxt.rcxcomm.PacketHandler
Receive a packet.
Rectangle - Class in lejos.geom
 
Rectangle(float, float, float, float) - Constructor for class lejos.geom.Rectangle
 
RED - Static variable in interface lejos.nxt.SensorConstants
 
RED - Static variable in class lejos.robotics.Color
 
RED_INDEX - Static variable in interface lejos.nxt.SensorConstants
Color sensor data RED value index.
REFLECTION - Static variable in interface lejos.nxt.remote.NXTProtocol
 
REG_PRODUCT_ID - Static variable in class lejos.nxt.I2CSensor
Returns the product ID of the sensor.
REG_SENSOR_TYPE - Static variable in class lejos.nxt.I2CSensor
Returns the sensor type.
REG_VERSION - Static variable in class lejos.nxt.I2CSensor
Returns the version number of the sensor.
regenerate() - Method in class lejos.robotics.pathfinding.FourWayGridMesh
 
regenerate() - Method in interface lejos.robotics.pathfinding.NavigationMesh
Throws away the previous set of nodes and recalculates them all.
REGULATED - Static variable in interface lejos.nxt.remote.NXTProtocol
Turns on the regulation
RegulatedMotor - Interface in lejos.robotics
Interface for encoded motors without limited range of movement (e.g.
RegulatedMotorListener - Interface in lejos.robotics
This interface defines a listener that is notified of the tachometer when the motor starts and stops rotating.
regulateSpeed(boolean) - Method in class lejos.nxt.addon.NXTMMXMotor
turns speed regulation on and off for tacho and time methods.
regulateSpeed(boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
REGULATION_MODE_IDLE - Static variable in interface lejos.nxt.remote.NXTProtocol
No regulation will be enabled
REGULATION_MODE_MOTOR_SPEED - Static variable in interface lejos.nxt.remote.NXTProtocol
Power control will be enabled on specified output
REGULATION_MODE_MOTOR_SYNC - Static variable in interface lejos.nxt.remote.NXTProtocol
Synchronization will be enabled (Needs enabled on two output)
regulationMode - Variable in class lejos.nxt.remote.OutputState
 
regulator - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
relativeBearing(Point) - Method in class lejos.robotics.navigation.Pose
Returns the angle to destination relative to the pose heading;
RemoteBattery - Class in lejos.nxt.remote
Battery readings from a remote NXT.
RemoteBattery(NXTCommand) - Constructor for class lejos.nxt.remote.RemoteBattery
 
RemoteFrame - Class in lejos.pc.comm
This class is useful for creating a PC GUI Application that connects to the NXT and exchanges data with it using Java streams.
RemoteFrame(String) - Constructor for class lejos.pc.comm.RemoteFrame
Create the GUI elements the map and the particle set and connect to the NXT.
RemoteMotor - Class in lejos.nxt.remote
Motor class.
RemoteMotor(NXTCommand, int) - Constructor for class lejos.nxt.remote.RemoteMotor
 
RemoteMotorPort - Class in lejos.nxt.remote
Supports a motor connected to a remote NXT
RemoteMotorPort(NXTCommand, int) - Constructor for class lejos.nxt.remote.RemoteMotorPort
 
removeLogListener(NXTCommLogListener) - Method in class lejos.pc.comm.NXTCommLoggable
unregister log listener
removeLogListener(NXTCommLogListener) - Method in class lejos.pc.comm.NXTConnectionManager
unregister log listener
removeNeighbor(Node) - Method in class lejos.robotics.pathfinding.Node
Removes a node from this node as neighbors, effectively disconnecting them.
removeNode(Node) - Method in class lejos.robotics.pathfinding.FourWayGridMesh
 
removeNode(Node) - Method in interface lejos.robotics.pathfinding.NavigationMesh
Removes a node from the set and removes any existing connections with its neighbors.
REPLY_COMMAND - Static variable in interface lejos.nxt.remote.NXTProtocol
 
REQUEST_FAILED - Static variable in interface lejos.nxt.remote.ErrorMessages
Request failed (i.e.
resample() - Method in class lejos.robotics.localization.MCLParticleSet
Resample the set picking those with higher weights.
reset() - Method in class lejos.nxt.addon.CruizcoreGyro
Resets the accumulated angle (heading).
reset() - Method in class lejos.nxt.addon.NXTMMX
resets mux values to default and stops all tasks.
reset() - Method in class lejos.nxt.rcxcomm.LLCReliableHandler
Reset sequence numbers.
reset() - Method in class lejos.nxt.rcxcomm.PacketHandler
Reset sequence numbers for this handler
reset() - Method in class lejos.nxt.rcxcomm.RCXAbstractPort
Resets sequence numbers for this port
reset() - Method in class lejos.nxt.UltrasonicSensor
Reset the device.
reset() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated.  
reset() - Method in class lejos.robotics.navigation.DifferentialPilot
Resets tacho count for both motors.
reset() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. Resets tacho count for both motors.
reset() - Method in class lejos.util.Stopwatch
Reset watch to zero
RESET_MOTOR_POSITION - Static variable in interface lejos.nxt.remote.NXTProtocol
 
RESET_SCALED_INPUT_VALUE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
resetAccAngle() - Method in class lejos.nxt.addon.AngleSensor
Reset the rotation count of accumulated angle to zero.
resetAccumulatedAngle() - Method in class lejos.nxt.addon.AngleSensor
 
resetBlockTacho() - Method in class lejos.nxt.remote.RemoteMotor
Deprecated.  
resetCartesianZero() - Method in class lejos.nxt.addon.CompassSensor
Changes the current direction the compass is facing into the zero angle.
resetCartesianZero() - Method in class lejos.nxt.addon.GyroDirectionFinder
Resets the current heading to zero.
resetCartesianZero() - Method in interface lejos.robotics.DirectionFinder
Changes the current direction the compass is facing into the zero angle.
resetCartesianZero() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated.  
resetMotorPosition(int, boolean) - Method in class lejos.nxt.remote.NXTCommand
Resets either RotationCount or BlockTacho
resetSerial() - Static method in class lejos.nxt.rcxcomm.Serial
Reset the link - null
resetTachoCount() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Resets the tachometer count to zero.
resetTachoCount() - Method in class lejos.nxt.addon.NXTMMXMotor
Resets the tachometer count to zero.
resetTachoCount() - Method in class lejos.nxt.addon.RCXRotationSensor
Reset the tacho count to zero.
resetTachoCount() - Method in class lejos.nxt.MotorPort
 
resetTachoCount() - Method in class lejos.nxt.remote.RemoteMotor
 
resetTachoCount() - Method in class lejos.nxt.remote.RemoteMotorPort
 
resetTachoCount() - Method in interface lejos.nxt.Tachometer
 
resetTachoCount() - Method in interface lejos.robotics.Encoder
Reset the tachometer count.
resume() - Method in class lejos.robotics.navigation.NavPathController
 
resume() - Method in interface lejos.robotics.navigation.PathController
Resumes following the route
retract(int, boolean) - Method in class lejos.nxt.addon.LinearActuator
Causes the actuator to retract distance in encoder ticks.
reverse() - Method in class lejos.geom.Point
 
RFIDSensor - Class in lejos.nxt.addon
Support for the Codatex RFID Sensor.
RFIDSensor(I2CPort) - Constructor for class lejos.nxt.addon.RFIDSensor
Create a class to provide access to the device.
rightOrth() - Method in class lejos.geom.Point
 
rotate(int, boolean) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Rotate by the requested number of degrees.
rotate(int) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Rotate by the requested number of degrees.
rotate(int) - Method in class lejos.nxt.addon.NXTMMXMotor
Causes motor to rotate by a specified angle.
rotate(int, boolean) - Method in class lejos.nxt.addon.NXTMMXMotor
same as rotate but returns immediately
rotate(int, boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
rotate(int) - Method in class lejos.nxt.remote.RemoteMotor
 
rotate(float, boolean) - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. robot rotates to the specified compass heading;
rotate(float) - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Rotates the NXT robot through a specific angle; Rotates left if angle is positive, right if negative, Returns when angle is reached.
rotate(double) - Method in class lejos.robotics.navigation.DifferentialPilot
Rotates the NXT robot through a specific angle.
rotate(double, boolean) - Method in class lejos.robotics.navigation.DifferentialPilot
Rotates the NXT robot through a specific angle.
rotate(float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Rotates the NXT robot through a specific number of degrees in a direction (+ or -).
rotate(float, boolean) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Rotates the NXT robot through a specific number of degrees in a direction (+ or -).
rotate(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
rotate(float, boolean) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
rotate(double) - Method in interface lejos.robotics.navigation.RotateMoveController
Rotates the NXT robot the specified number of degrees; direction determined by the sign of the parameter.
rotate(double, boolean) - Method in interface lejos.robotics.navigation.RotateMoveController
Rotates the NXT robot the specified number of degrees; direction determined by the sign of the parameter.
rotate(int, boolean) - Method in interface lejos.robotics.RegulatedMotor
causes motor to rotate through angle;
iff immediateReturn is true, method returns immediately and the motor stops by itself
If any motor method is called before the limit is reached, the rotation is canceled.
rotate(int) - Method in interface lejos.robotics.RegulatedMotor
Causes motor to rotate by a specified angle.
rotateLeft() - Method in class lejos.robotics.navigation.DifferentialPilot
 
rotateLeft() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
RotateMoveController - Interface in lejos.robotics.navigation
 
rotateRight() - Method in class lejos.robotics.navigation.DifferentialPilot
 
rotateRight() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
rotateTime(int, boolean) - Method in class lejos.nxt.addon.NXTMMXMotor
Rotates the motor for specified amount of time
rotateTime(int, boolean, boolean) - Method in class lejos.nxt.addon.NXTMMXMotor
runs motor for specified amount of time and immediately returns
rotateTo(int, boolean) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Rotate to the target angle.
rotateTo(int) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Rotate to the target angle.
rotateTo(int) - Method in class lejos.nxt.addon.NXTMMXMotor
rotates to the tacho position indicated.
rotateTo(int, boolean) - Method in class lejos.nxt.addon.NXTMMXMotor
rotates to the tacho position that you want and immediately returns.
rotateTo(int) - Method in class lejos.nxt.remote.RemoteMotor
 
rotateTo(int, boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
rotateTo(float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Rotates the NXT robot to point in a specific direction, using the smallest rotation necessary
rotateTo(float, boolean) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Rotates the NXT robot to point in a specific direction relative to the x axis.
rotateTo(int) - Method in interface lejos.robotics.RegulatedMotor
Causes motor to rotate to limitAngle;
Then getTachoCount should be within +- 2 degrees of the limit angle when the method returns
rotateTo(int, boolean) - Method in interface lejos.robotics.RegulatedMotor
causes motor to rotate to limitAngle;
if immediateReturn is true, method returns immediately and the motor stops by itself
and getTachoCount should be within +- 2 degrees if the limit angle If any motor method is called before the limit is reached, the rotation is canceled.
rotateUpdate(float) - Method in class lejos.robotics.navigation.Pose
Rotate the heading through the specified angle
RotatingRangeScanner - Class in lejos.robotics
Implementation of RangeScanner with a rotating ultrasonic sensor or other range finder
RotatingRangeScanner(RegulatedMotor, RangeFinder) - Constructor for class lejos.robotics.RotatingRangeScanner
The constructor specifies the motor and range finder used
rotationCount - Variable in class lejos.nxt.remote.OutputState
 
rotationStarted(RegulatedMotor, int, boolean, long) - Method in class lejos.robotics.navigation.DifferentialPilot
MotorListener interface method is called by RegulatedMotor when a motor rotation starts.
rotationStarted(RegulatedMotor, int, boolean, long) - Method in class lejos.robotics.navigation.SteeringPilot
 
rotationStarted(RegulatedMotor, int, boolean, long) - Method in interface lejos.robotics.RegulatedMotorListener
Called when the motor starts rotating.
rotationStopped(RegulatedMotor, int, boolean, long) - Method in class lejos.robotics.navigation.DifferentialPilot
called by RegulatedMotor when a motor rotation is complete calls movementStop() after both motors stop;
rotationStopped(RegulatedMotor, int, boolean, long) - Method in class lejos.robotics.navigation.SteeringPilot
 
rotationStopped(RegulatedMotor, int, boolean, long) - Method in interface lejos.robotics.RegulatedMotorListener
Called when the motor stops rotating.
ROTSTOP_BRAKE - Static variable in class lejos.nxt.addon.MMXRegulatedMotor
Use to specify motor brake when a rotate method completes.
ROTSTOP_FLOAT - Static variable in class lejos.nxt.addon.MMXRegulatedMotor
Use to specify motor float when a rotate method completes.
ROTSTOP_LOCK - Static variable in class lejos.nxt.addon.MMXRegulatedMotor
Use to specify active hold when a rotate method completes.
run() - Method in class lejos.nxt.addon.RCXRotationSensor.Reader
Sensor reader thread.
run() - Method in class lejos.robotics.navigation.NavPathController.Nav
 
RUN_PROGRAM_1 - Static variable in class lejos.nxt.addon.RCXLink
 
RUN_PROGRAM_2 - Static variable in class lejos.nxt.addon.RCXLink
 
RUN_PROGRAM_3 - Static variable in class lejos.nxt.addon.RCXLink
 
RUN_PROGRAM_4 - Static variable in class lejos.nxt.addon.RCXLink
 
RUN_PROGRAM_5 - Static variable in class lejos.nxt.addon.RCXLink
 
runCommand(int) - Method in class lejos.nxt.addon.PFLink
Executes a command
runMacro(int) - Method in class lejos.nxt.addon.PFLink
Runs a macro which has been previously installed on the NRLink.
runMacro(int) - Method in class lejos.nxt.addon.RCXLink
 
runProgram(int) - Method in class lejos.nxt.addon.IRLink
 
runProgram(int) - Method in interface lejos.nxt.addon.IRTransmitter
 
runProgram(int) - Method in class lejos.nxt.addon.RCXLink
 
runState - Variable in class lejos.nxt.remote.OutputState
 

S

S1 - Static variable in class lejos.nxt.SensorPort
 
S2 - Static variable in class lejos.nxt.SensorPort
 
S3 - Static variable in class lejos.nxt.SensorPort
 
S4 - Static variable in class lejos.nxt.SensorPort
 
saveNXJCache(Properties, String) - Static method in class lejos.pc.comm.NXTCommFactory
Save the leJOS NXJ Properties
saveNXJProperties(Properties, String) - Static method in class lejos.pc.comm.NXTCommFactory
Save the leJOS NXJ Properties
scaledValue - Variable in class lejos.nxt.remote.InputValues
The scaled value starts working after the first call to the sensor.
scan() - Method in interface lejos.robotics.objectdetection.FeatureDetector
Performs a single scan for an object and returns the results.
scan() - Method in class lejos.robotics.objectdetection.FeatureDetectorAdapter
 
scan() - Method in class lejos.robotics.objectdetection.FusorDetector
This method scans all the sensors added to this object and returns the amalgamated results.
scan() - Method in class lejos.robotics.objectdetection.RangeFeatureDetector
 
scan() - Method in class lejos.robotics.objectdetection.TouchFeatureDetector
 
search(String, int) - Method in interface lejos.pc.comm.NXTComm
Search for NXTs over USB, Bluetooth or both
search(String, int) - Method in class lejos.pc.comm.NXTCommBluecove
 
search(String, int) - Method in class lejos.pc.comm.NXTCommBluez
 
search(String, int) - Method in class lejos.pc.comm.NXTCommUSB
Locate available nxt devices and return them.
search() - Method in class lejos.pc.comm.NXTConnectionManager
searches for available NXT bricks automatically connects to the first one found (TODO: correct?)
search(String, String, int) - Method in class lejos.pc.comm.NXTConnector
Search for a NXT
search() - Method in class lejos.pc.comm.NXTSamba
Locate all NXT devices that are running in SAM-BA mode.
SearchAlgorithm - Interface in lejos.robotics.pathfinding
An interface for defining generic node search algorithms.
segDist(Line) - Method in class lejos.geom.Line
Returns the minimum distance between two line segments--this line segment and another.
segmentBlocked(DijkstraPathFinder.Node, DijkstraPathFinder.Node) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
helper method for findPath().
segmentBlocked(ShortestPathFinder.Node, ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
helper method for findPath().
sendBytes(byte[], int) - Method in class lejos.nxt.addon.IRLink
 
sendBytes(byte[], int) - Method in interface lejos.nxt.addon.IRTransmitter
Send raw bytes to the RCX
sendBytes(byte[], int) - Method in class lejos.nxt.addon.RCXLink
 
sendBytes(byte[], int) - Static method in class lejos.nxt.rcxcomm.LLC
Send a number of bytes and wait for completion of transmission
sendCommand(char) - Method in class lejos.nxt.addon.NXTCam
Send a single byte command represented by a letter
sendCommand(NXTLineLeader.Command) - Method in class lejos.nxt.addon.NXTLineLeader
Send a single byte command represented by a letter
sendCommand(char) - Method in class lejos.nxt.addon.NXTLineLeader
Deprecated. use NXTLineLeader.sendCommand(Command) instead
sendCommand(int, int, int) - Method in class lejos.nxt.addon.RCXMotorMultiplexer
 
sendData(int, byte) - Method in class lejos.nxt.I2CSensor
Sets a single byte in the I2C sensor.
sendData(int, byte[], int) - Method in class lejos.nxt.I2CSensor
 
sendData(int, byte[], int, int) - Method in class lejos.nxt.I2CSensor
Send data top the sensor
sendData(int, byte[], int, int) - Method in class lejos.nxt.UltrasonicSensor
 
sendF7(int) - Method in class lejos.nxt.addon.RCXLink
 
sendMessage(byte[], int) - Static method in class lejos.nxt.Inbox
 
sendPacket(byte[]) - Method in class lejos.nxt.addon.IRLink
 
sendPacket(byte[]) - Method in interface lejos.nxt.addon.IRTransmitter
Send a packet of data to the RCX
sendPacket(byte[]) - Method in class lejos.nxt.addon.RCXLink
 
sendPacket(byte[], int) - Method in class lejos.nxt.rcxcomm.LLCHandler
Send a packet.
sendPacket(byte[], int) - Method in class lejos.nxt.rcxcomm.LLCReliableHandler
Send a packet.
sendPacket(byte[], int) - Method in class lejos.nxt.rcxcomm.PacketHandler
Send a packet.
sendPacket(byte[], int, int) - Static method in class lejos.nxt.rcxcomm.Serial
Send a packet
sendPFComboDirect(int, int, int) - Method in class lejos.nxt.addon.IRLink
Send commands to both motors.
sendRemoteCommand(int) - Method in class lejos.nxt.addon.IRLink
 
sendRemoteCommand(int) - Method in interface lejos.nxt.addon.IRTransmitter
Send a remote control command to the RCX
sendRemoteCommand(int) - Method in class lejos.nxt.addon.RCXLink
 
sendRequest(byte[], int) - Method in interface lejos.nxt.remote.NXTCommRequest
Send an LCP message to the NXT and receive a reply
sendRequest(byte[], int) - Method in class lejos.pc.comm.NXTCommBluecove
Sends a request to the NXT brick.
sendRequest(byte[], int) - Method in class lejos.pc.comm.NXTCommBluez
 
sendRequest(byte[], int) - Method in class lejos.pc.comm.NXTCommUSB
Send a Lego Command Protocol (LCP) request to the device.
SensorConstants - Interface in lejos.nxt
Constants used to set Sensor types and modes.
sensorMode - Variable in class lejos.nxt.remote.InputValues
 
SensorMux - Class in lejos.nxt.addon
 
SensorMux(I2CPort) - Constructor for class lejos.nxt.addon.SensorMux
Constructor
SensorPort - Class in lejos.nxt
Port class.
SensorSelector - Class in lejos.nxt.addon
Factory for I2C sensor implementations.
SensorSelector() - Constructor for class lejos.nxt.addon.SensorSelector
 
SensorSelectorException - Exception in lejos.nxt.addon
 
SensorSelectorException(String) - Constructor for exception lejos.nxt.addon.SensorSelectorException
 
sensorType - Variable in class lejos.nxt.remote.InputValues
 
Serial - Class in lejos.nxt.rcxcomm
Emulation of the RCX Serial class with Mindsensors NRLINK adapter.
servicesDiscovered(int, ServiceRecord[]) - Method in class lejos.pc.comm.NXTCommBluecove
 
serviceSearchCompleted(int, int) - Method in class lejos.pc.comm.NXTCommBluecove
 
servo1 - Variable in class lejos.nxt.addon.MSC
Servo at location 1
servo2 - Variable in class lejos.nxt.addon.MSC
Servo at location 2
servo3 - Variable in class lejos.nxt.addon.MSC
Servo at location 3
servo4 - Variable in class lejos.nxt.addon.MSC
Servo at location 4
servo5 - Variable in class lejos.nxt.addon.MSC
Servo at location 5
servo6 - Variable in class lejos.nxt.addon.MSC
Servo at location 6
servo7 - Variable in class lejos.nxt.addon.MSC
Servo at location 7
servo8 - Variable in class lejos.nxt.addon.MSC
Servo at location 8
set(int, int, double) - Method in class lejos.util.Matrix
Set a single element.
SET_BRICK_NAME - Static variable in interface lejos.nxt.remote.NXTProtocol
 
SET_INPUT_MODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
SET_OUTPUT_STATE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
setAcceleration(int) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Sets speed ramping is enabled/disabled for this motor.
setAcceleration(int) - Method in class lejos.nxt.remote.RemoteMotor
 
setAcceleration(int) - Method in class lejos.robotics.navigation.DifferentialPilot
Sets the acceleration of both motors.
setAcceleration(int) - Method in interface lejos.robotics.RegulatedMotor
Set the required rate of acceleration degrees/s/s
setAccScale(byte) - Method in class lejos.nxt.addon.CruizcoreGyro
Sets the acc scale.
setAccScale2G() - Method in class lejos.nxt.addon.CruizcoreGyro
Sets the acceleration scale factor to 2G.
setAccScale4G() - Method in class lejos.nxt.addon.CruizcoreGyro
Sets the acceleration scale factor to 4G.
setAccScale8G() - Method in class lejos.nxt.addon.CruizcoreGyro
Sets the acceleration scale factor to 8G.
setAddress(int) - Method in class lejos.nxt.I2CSensor
Deprecated. If the device has a changeable address, then constructor of the class should have an address parameter. If not, please report a bug.
setADPAMode(boolean) - Method in class lejos.nxt.addon.PSPNXController
Use ADPA mode only if you are trying to connect more than one I2C sensor to a single port.
setAngle(int) - Method in class lejos.nxt.addon.LServo
Method to set an Angle in a RC Servo.
setAngle(int) - Method in class lejos.nxt.addon.MServo
Method to set an Angle in a RC Servo.
setAngleNoiseFactor(float) - Method in class lejos.robotics.localization.MCLParticleSet
Set the distance angle factor
setAngles(float[]) - Method in class lejos.robotics.FixedRangeScanner
 
setAngles(float[]) - Method in interface lejos.robotics.RangeScanner
Set the array of angles at which range readings are to be taken
setAngles(float[]) - Method in class lejos.robotics.RotatingRangeScanner
set the angles to be used by the getRangeValues() method
setAPDAOff() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Disables (ADPA) Auto Detecting Parallel Architecture.
Disabled by default.
setAPDAOff() - Method in class lejos.nxt.addon.RCXLink
 
setAPDAOn() - Method in class lejos.nxt.addon.OpticalDistanceSensor
Enables (ADPA) Auto Detecting Parallel Architecture.
setAPDAOn() - Method in class lejos.nxt.addon.RCXLink
 
setAutoStart(boolean) - Method in class lejos.nxt.addon.NXTMMX
Turns autostart on or off.
setBackwardMaxSpeed(int) - Method in class lejos.nxt.addon.LDCMotor
 
setBackwardMinSpeed(int) - Method in class lejos.nxt.addon.LDCMotor
 
setBorder(int) - Method in class lejos.robotics.localization.MCLParticleSet
Set border where no particles should be generated
setBrickName(String) - Static method in class lejos.nxt.NXT
Set the friendly name of the brick
setByte(int, byte) - Method in interface lejos.robotics.Clock
 
setCalibrationData(byte[]) - Method in class lejos.nxt.UltrasonicSensor
Set 3 bytes of calibration data.
setChannel(int) - Method in class lejos.nxt.addon.PFMate
Sets PF channel to use.
setChannelFour() - Method in class lejos.nxt.addon.RCXSensorMultiplexer
Selects channel four
setChannelOne() - Method in class lejos.nxt.addon.RCXSensorMultiplexer
Selects channel one
setChannelThree() - Method in class lejos.nxt.addon.RCXSensorMultiplexer
Selects channel three
setChannelTwo() - Method in class lejos.nxt.addon.RCXSensorMultiplexer
Selects channel two
setClearance(float) - Method in class lejos.robotics.pathfinding.FourWayGridMesh
Changes the safety zone between all nodes/connections and map geometry.
setClosest(int) - Method in class lejos.pc.comm.MCLPanel
 
setContinuousInterval(int) - Method in class lejos.nxt.UltrasonicSensor
Set the ping inetrval used when in continuous mode.
setCurveCount(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets the number of points that will be in the configured curve.
setDate(int, int, int) - Method in interface lejos.robotics.Clock
 
setDBA(boolean) - Method in class lejos.nxt.SoundSensor
Set DB or DBA mode.
setDebug(boolean) - Method in class lejos.pc.comm.NXTConnector
Set debugging on or off
setDebug(boolean) - Static method in class lejos.robotics.localization.MCLParticle
 
setDebug(boolean) - Method in class lejos.robotics.localization.MCLParticleSet
Set system out debugging on or off
setDebug(boolean) - Method in class lejos.robotics.localization.MCLPoseProvider
Set debugging on or off
setDefaultSpeed() - Method in class lejos.nxt.addon.RCXLink
 
setDegrees(float) - Method in class lejos.nxt.addon.GyroDirectionFinder
Resets the current heading to a desired value.
setDegreesCartesian(float) - Method in class lejos.nxt.addon.GyroDirectionFinder
Resets the current heading to a desired value.
setDelay(int) - Method in class lejos.nxt.addon.LMotor
Set a delay in a Motor
setDelay(int) - Method in interface lejos.robotics.objectdetection.FeatureDetector
Sets the minimum delay between readings from the feature detector.
setDelay(int) - Method in class lejos.robotics.objectdetection.FeatureDetectorAdapter
 
setDelay(int) - Method in class lejos.robotics.objectdetection.FusorDetector
 
setDigitalMode(boolean) - Method in class lejos.nxt.addon.PSPNXController
 
setDirection(int, int) - Method in class lejos.nxt.addon.RCXMotorMultiplexer
 
setDistanceNoiseFactor(float) - Method in class lejos.robotics.localization.MCLParticleSet
Set the distance noise factor
setDistMaxLSB(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets the max value in millimeters for LSB.
Used for recalibrating the sensor.
setDistMaxMSB(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets the max value in millimeters for the MSB.
Used for recalibrating the sensor.
setDistMinLSB(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets the min value in millimeters for the LSB.
Used for recalibrating the sensor.
setDistMinMSB(int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets the min value in millimeters for the MSB.
Used for recalibrating the sensor.
setDistPointLSB(int, int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets millimeter value of the specific index for the LSB.
setDistPointMSB(int, int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets millimeter value of the specific index for the MSB.
setErr(Writer) - Static method in class lejos.pc.comm.SystemContext
Deprecated.  
setFloodlight(boolean) - Method in class lejos.nxt.addon.RCXLightSensor
 
setFloodlight(int) - Method in class lejos.nxt.addon.RCXLightSensor
 
setFloodlight(boolean) - Method in class lejos.nxt.ColorSensor
 
setFloodlight(int) - Method in class lejos.nxt.ColorSensor
 
setFloodlight(boolean) - Method in class lejos.nxt.LightSensor
 
setFloodlight(int) - Method in class lejos.nxt.LightSensor
 
setFloodlight(boolean) - Method in interface lejos.robotics.LampLightDetector
Turns the default LED light on or off.
setFloodlight(int) - Method in interface lejos.robotics.LampLightDetector
Used to turn on or off the floodlight by color.
setForwardMaxSpeed(int) - Method in class lejos.nxt.addon.LDCMotor
 
setForwardMinSpeed(int) - Method in class lejos.nxt.addon.LDCMotor
 
setFriendlyName(String) - Method in class lejos.nxt.remote.NXTCommand
Set the friendly name of the NXT
setG_Score(float) - Method in class lejos.robotics.pathfinding.Node
Method used by A* to calculate search score.
setGridSpacing(float) - Method in class lejos.robotics.pathfinding.FourWayGridMesh
Change the size of each grid square.
setH_Score(float) - Method in class lejos.robotics.pathfinding.Node
Method used by A* to calculate search score.
setHeading(float) - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. sets direction of desired robot facing in degrees
setHeading(float) - Method in class lejos.robotics.navigation.Pose
 
setHigh(int) - Method in class lejos.nxt.addon.RCXLightSensor
set the normalized value corresponding to readValue() = 100;
setHigh(int) - Method in class lejos.nxt.ColorSensor
set the normalized value corresponding to readValue() = 100;
setHigh(int) - Method in class lejos.nxt.LightSensor
set the normalized value corresponding to readValue() = 100%
setHighSpeed() - Method in class lejos.nxt.addon.RCXLink
 
setHourMode(boolean) - Method in interface lejos.robotics.Clock
 
setIn(Reader) - Static method in class lejos.pc.comm.SystemContext
Deprecated.  
setInitialPose(Pose, float, float) - Method in class lejos.robotics.localization.MCLPoseProvider
Generates an initial particle set in a circular normal distribution, centered on aPose.
setInitialPose(RangeReadings, float) - Method in class lejos.robotics.localization.MCLPoseProvider
Generates an initial particle set using the range readings.
setInputMode(int, int, int) - Method in class lejos.nxt.remote.NXTCommand
Tells the NXT what type of sensor you are using and the mode to operate in.
setKD(int) - Method in class lejos.nxt.addon.NXTLineLeader
Set KD value
setKDDivisor(int) - Method in class lejos.nxt.addon.NXTLineLeader
Set the KD divisor
setKI(int) - Method in class lejos.nxt.addon.NXTLineLeader
Set KI value
setKIDivisor(int) - Method in class lejos.nxt.addon.NXTLineLeader
Set the KI divisor
setKP(int) - Method in class lejos.nxt.addon.NXTLineLeader
Set KP value
setKPDivisor(int) - Method in class lejos.nxt.addon.NXTLineLeader
Set the KP divisor
setLatitude(int) - Method in class lejos.nxt.addon.GPSSensor
Set destination latitude coordinates
setListen(boolean) - Method in class lejos.nxt.rcxcomm.PacketHandler
Set or unset the listen flag to keep a PC serial tower alive
setLocation(Point) - Method in class lejos.robotics.navigation.Pose
Set the location of the pose
setLocation(float, float) - Method in class lejos.robotics.navigation.Pose
Sets the location of this pose to a new point at x,y;
setLongitude(int) - Method in class lejos.nxt.addon.GPSSensor
Set destination longitude coordinates
setLow(int) - Method in class lejos.nxt.addon.RCXLightSensor
set the normalized value corresponding to readValue() = 0
setLow(int) - Method in class lejos.nxt.ColorSensor
set the normalized value corresponding to readValue() = 0
setLow(int) - Method in class lejos.nxt.LightSensor
set the normalized value corresponding to readValue() = 0%
setMap(ArrayList<Line>) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
 
setMap(LineMap) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
 
setMap(LineMap) - Method in class lejos.robotics.pathfinding.FourWayGridMesh
Feeds this class a new map.
setMap(ArrayList<Line>) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
setMap(LineMap) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
setMatrix(int, int, int, int, Matrix) - Method in class lejos.util.Matrix
Set a submatrix.
setMatrix(int[], int[], Matrix) - Method in class lejos.util.Matrix
Set a submatrix.
setMatrix(int[], int, int, Matrix) - Method in class lejos.util.Matrix
Set a submatrix.
setMatrix(int, int, int[], Matrix) - Method in class lejos.util.Matrix
Set a submatrix.
setMaxAngle(int) - Method in class lejos.nxt.addon.LServo
Set Maximum angle.
setMaxDistance(float) - Method in class lejos.robotics.objectdetection.RangeFeatureDetector
Sets the maximum distance to register detected objects from the range finder.
setMaxHeadingError(double) - Method in class lejos.robotics.navigation.WayPoint
 
setMaxIterations(int) - Method in class lejos.robotics.localization.MCLParticleSet
Set the maximum iterations for the resample algorithm
setMaxPositionError(double) - Method in class lejos.robotics.navigation.WayPoint
 
setMinAngle(int) - Method in class lejos.nxt.addon.LServo
Set Minimal angle.
setMinRadius(double) - Method in interface lejos.robotics.navigation.ArcMoveController
Set the radius of the minimum turning circle.
setMinRadius(double) - Method in class lejos.robotics.navigation.DifferentialPilot
Set the radius of the minimum turning circle.
setMinRadius(double) - Method in class lejos.robotics.navigation.SteeringPilot
 
setMode(IRSeekerV2.Mode) - Method in class lejos.nxt.addon.IRSeekerV2
Set the mode of the sensor
setMode(int) - Method in interface lejos.nxt.BasicSensorPort
 
setMode(int) - Method in class lejos.nxt.SensorPort
 
setMode(int) - Method in class lejos.nxt.UltrasonicSensor
Set the sensor into the specified mode.
setModeLong() - Method in class lejos.nxt.addon.EOPD
Changes the port to long range mode.
setModeShort() - Method in class lejos.nxt.addon.EOPD
Changes the sensor to short range mode.
setMotor(int) - Method in class lejos.nxt.addon.PFMate
Determines which motors are to be used buy default both are activated
setMotorPower(int, int) - Method in class lejos.nxt.addon.RCXLink
 
setMoveSpeed(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. 
setNavMesh(NavigationMesh) - Method in class lejos.robotics.pathfinding.NodePathFinder
Method for changing the navigation mesh after this has been instantiated.
setNxjHome(String) - Static method in class lejos.pc.comm.SystemContext
Deprecated.  
setNXTComm(NXTCommRequest) - Method in class lejos.nxt.remote.NXTCommand
Set the NXTComm used to communicate with the NXT.
setOffset(int) - Method in class lejos.nxt.addon.GyroSensor
Set the offset used by readValue().
setOut(Writer) - Static method in class lejos.pc.comm.SystemContext
Deprecated.  
setOutputState(int, byte, int, int, int, int, int) - Method in class lejos.nxt.remote.NXTCommand
 
setPathFinder(PathFinder) - Method in class lejos.robotics.navigation.NavPathController
 
setPort(SensorPort) - Static method in class lejos.nxt.rcxcomm.LLC
Set sensor port
setPort(SensorPort) - Static method in class lejos.nxt.rcxcomm.Serial
Set the sensor port
setPose(Pose) - Method in class lejos.robotics.localization.MCLPoseProvider
 
setPose(Pose) - Method in class lejos.robotics.localization.OdometryPoseProvider
 
setPose(Pose) - Method in interface lejos.robotics.localization.PoseProvider
 
setPose(float, float, float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. sets the robot pose to the new coordinates and heading
setPose(Pose) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. sets the robot pose
setPoseProvider(PoseProvider) - Method in class lejos.robotics.navigation.NavPathController
 
setPoseProvider(PoseProvider) - Method in interface lejos.robotics.navigation.PathController
Sets a new PoseProvider for the PathController robot to use.
setPosition(float, float, float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
setPower(int) - Method in class lejos.nxt.addon.LinearActuator
Sets the power for the actuator.
setPower(int) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Set the power level 0-100% to be applied to the motor.
setPower(int) - Method in class lejos.nxt.addon.PFMateMotor
 
setPower(int) - Method in class lejos.nxt.BasicMotor
 
setPower(int) - Method in class lejos.nxt.remote.RemoteMotor
Sets the power of the motor
setPower(int) - Method in interface lejos.robotics.DCMotor
Set the power level 0%-100% to be applied to the motor
setPredecessor(DijkstraPathFinder.Node) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
set the predecessor of this node in the shortest path from the start node
setPredecessor(Node) - Method in class lejos.robotics.pathfinding.Node
Used by A* search.
setPredecessor(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
set the predecessor of this node in the shortest path from the start node
setPulse(int) - Method in class lejos.nxt.addon.LMotor
This class set the Pulse over a RC Servo or a DC Motor
setPulse(int) - Method in class lejos.nxt.addon.MServo
This method set the pulse in a RC Servo.
setPWMMode(int) - Method in class lejos.nxt.addon.PFMotorPort
 
setPWMMode(int) - Method in class lejos.nxt.addon.RCXPlexedMotorPort
 
setPWMMode(int) - Method in class lejos.nxt.addon.RCXRemoteMotorPort
 
setPWMMode(int) - Method in interface lejos.nxt.BasicMotorPort
 
setPWMMode(int) - Method in class lejos.nxt.MotorPort
 
setPWMMode(int) - Method in class lejos.nxt.remote.RemoteMotorPort
 
setRange(int, float, float) - Method in class lejos.robotics.RangeReadings
Set the range reading
setRangeLong() - Method in class lejos.nxt.addon.RCXLink
 
setRangeLong() - Static method in class lejos.nxt.rcxcomm.LLC
Sets long range transmision.
setRangeLong() - Static method in class lejos.nxt.rcxcomm.Serial
Set long range
setRangeShort() - Method in class lejos.nxt.addon.RCXLink
 
setRangeShort() - Static method in class lejos.nxt.rcxcomm.LLC
Sets short range transmision.
setRangeShort() - Static method in class lejos.nxt.rcxcomm.Serial
Set short range
setRawMode() - Method in class lejos.nxt.addon.RCXLink
 
setRCXRangeLong() - Method in class lejos.nxt.addon.RCXLink
 
setRCXRangeShort() - Method in class lejos.nxt.addon.RCXLink
 
setRegulationMode(int) - Method in class lejos.nxt.remote.RemoteMotor
This method determines if and how the motor will be regulated.
setRotateSpeed(double) - Method in class lejos.robotics.navigation.DifferentialPilot
sets the rotation speed of the vehicle, degrees per second
setRotateSpeed(float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. sets the robot turn speed -degrees/second
setRotateSpeed(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
setRotateSpeed(double) - Method in interface lejos.robotics.navigation.RotateMoveController
sets the rotation speed of the robot (the angular velocity of the rotate() methods)
setRotateStopMode(int) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Sets the motor stopping mode used for the rotate methods after rotation completion.
setSearchAlgorithm(SearchAlgorithm) - Method in class lejos.robotics.pathfinding.NodePathFinder
Method for changing the search algorithm after this has been instantiated.
setSensorModule(byte) - Method in class lejos.nxt.addon.OpticalDistanceSensor
This only needs the be run if you are changing the sensor.
setSetPoint(int) - Method in class lejos.nxt.addon.NXTLineLeader
Set the set point of the PID
setSigma(float) - Method in class lejos.robotics.localization.MCLParticleSet
Set the standard deviation for the sensor probability model
setSourceDistance(float) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
set the distance of this Node from the source
setSourceDistance(float) - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
set the distance of this Node from the source
setSpeed(int) - Method in class lejos.nxt.addon.LDCMotor
Method to set the speed in a DC Motor
setSpeed(int) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Sets desired motor speed, in degrees per second.
setSpeed(int) - Method in class lejos.nxt.addon.MServo
Method to set the Speed in a RC Servo.
setSpeed(int) - Method in class lejos.nxt.addon.NXTMMXMotor
sets motor speed.
setSpeed(int) - Method in class lejos.nxt.addon.PFMateMotor
Sets the motors speed
setSpeed(int, int) - Method in class lejos.nxt.addon.RCXMotorMultiplexer
 
setSpeed(int) - Method in class lejos.nxt.remote.RemoteMotor
 
setSpeed(int) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. in 0.8, use setRotateSpeed() and setTravelSpeed(). The method was deprecated, as this it requires knowledge of the robots physical construction, which this interface should hide!
setSpeed(int) - Method in interface lejos.robotics.RegulatedMotor
Set motor speed.
setState(Matrix, Matrix) - Method in class lejos.util.KalmanFilter
 
setTachoBreak(boolean) - Method in class lejos.nxt.addon.NXTMMXMotor
when this bit is set after tacho methods the motor will break.
setTachoLock(boolean) - Method in class lejos.nxt.addon.NXTMMXMotor
when using this bit after tacho methods force feed back will be used to hold the motor in place.
setTime(int, int, int) - Method in interface lejos.robotics.Clock
 
setTimeOut(int) - Method in class lejos.nxt.rcxcomm.RCXAbstractPort
Setter for property timeOut.
setTrackingMode(char) - Method in class lejos.nxt.addon.NXTCam
Choose either object or line tracking mode.
setTravelSpeed(double) - Method in class lejos.robotics.navigation.DifferentialPilot
set travel speed in wheel diameter units per second
setTravelSpeed(float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. sets the robots movement speed - distance units/second
setTravelSpeed(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. also sets _motorSpeed
setTravelSpeed(double) - Method in interface lejos.robotics.navigation.MoveController
Sets the speed at which the robot will travel forward and backward (and to some extent arcs, although actual arc speed is slightly less).
setTravelSpeed(double) - Method in class lejos.robotics.navigation.SteeringPilot
 
setTurnSpeed(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. 
setType(int) - Method in interface lejos.nxt.BasicSensorPort
 
setType(int) - Method in class lejos.nxt.ColorSensor
Change the type of the sensor
setType(int) - Method in class lejos.nxt.SensorPort
 
setTypeAndMode(int, int) - Method in interface lejos.nxt.BasicSensorPort
 
setTypeAndMode(int, int) - Method in class lejos.nxt.SensorPort
 
setValues(Move.MoveType, float, float, boolean) - Method in class lejos.robotics.navigation.Move
use this method to recycle an existing Move instead of creating a new one
setVerify(boolean) - Method in class lejos.nxt.remote.NXTCommand
Toggle the verify flag.
setVoltPointLSB(int, int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets millivolts value of the specific index for the LSB.
setVoltPointMSB(int, int) - Method in class lejos.nxt.addon.OpticalDistanceSensor
Sets millivolts value of the specific index for the MSB.
setWeight(float) - Method in class lejos.robotics.localization.MCLParticle
Set the weight for this particle
ShapefileLoader - Class in lejos.robotics.mapping
This class loads map data from a Shapefile and produces a LineMap object, which can be used by the leJOS navigation package.
ShapefileLoader(InputStream) - Constructor for class lejos.robotics.mapping.ShapefileLoader
Creates a ShapefileLoader object using an input stream.
SHORT_RANGE_IR - Static variable in class lejos.nxt.addon.RCXLink
 
ShortestPathFinder - Class in lejos.robotics.pathfinding
This class calculates the shortest path from a starting point to a finish point.
ShortestPathFinder(LineMap) - Constructor for class lejos.robotics.pathfinding.ShortestPathFinder
 
ShortestPathFinder.Node - Class in lejos.robotics.pathfinding
 
ShortestPathFinder.Node(Point) - Constructor for class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
ShortestPathFinder.Node(float, float) - Constructor for class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
shutdown() - Method in class lejos.nxt.addon.LinearActuator
Shut down the worker threads for this class and null the MotorPort ref.
signalStrength - Variable in class lejos.nxt.remote.DeviceInfo
 
SIZE - Static variable in class lejos.nxt.addon.NXTCam
Used by sortBy() to choose sorting criteria based on size (ordered largest to smallest).
sleep() - Method in class lejos.nxt.addon.NXTLineLeader
Sleep the sensor
SLOPEMASK - Static variable in interface lejos.nxt.remote.NXTProtocol
 
smoothAcceleration(boolean) - Method in class lejos.nxt.addon.NXTMMXMotor
enables and disables speed ramping
smoothAcceleration(boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
solve(Matrix) - Method in class lejos.util.LUDecomposition
Solve A*X = B
solve(Matrix) - Method in class lejos.util.Matrix
Solve A*X = B
sortBy(char) - Method in class lejos.nxt.addon.NXTCam
Camera sorts objects it detects according to criteria, either color, size, or no sorting at all.
Sound - Class in lejos.nxt
Sound class.
SOUND_DB - Static variable in interface lejos.nxt.remote.NXTProtocol
 
SOUND_DBA - Static variable in interface lejos.nxt.remote.NXTProtocol
 
SoundSensor - Class in lejos.nxt
Abstraction for a NXT sound sensor.
SoundSensor(ADSensorPort) - Constructor for class lejos.nxt.SoundSensor
Create a sound sensor object attached to the specified port.
SoundSensor(ADSensorPort, boolean) - Constructor for class lejos.nxt.SoundSensor
Create a sound sensor object attached to the specified port, and sets DB or DBA mode.
SPECIFIED_CHANNEL_CONNECTION_IS_NOT_VALID - Static variable in interface lejos.nxt.remote.ErrorMessages
Specified channel/connection is not valid
SPECIFIED_CHANNEL_CONNECTION_NOT_CONFIGURED_OR_BUSY - Static variable in interface lejos.nxt.remote.ErrorMessages
Specified channel/connection not configured or busy
SPECIFIED_MAILBOX_QUEUE_IS_EMPTY - Static variable in interface lejos.nxt.remote.ErrorMessages
 
SPI_PORT - Variable in class lejos.nxt.addon.LMotor
 
stalled() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
STANDARD_MODE - Static variable in interface lejos.nxt.I2CPort
 
START_PROGRAM - Static variable in interface lejos.nxt.remote.NXTProtocol
 
startBootLoader() - Method in class lejos.nxt.addon.RFIDSensor
Enter boot loader mode.
startCalibration() - Method in class lejos.nxt.addon.CompassSensor
Starts calibration for Mindsensors.com compass.
startCalibration() - Method in class lejos.nxt.addon.GyroDirectionFinder
Find offset/bias of gyro while at rest (ensure it is at rest).
startCalibration() - Method in interface lejos.robotics.DirectionFinder
Starts calibration.
startContinuousRead() - Method in class lejos.nxt.addon.RFIDSensor
Start continually reading from the device.
startFirmware() - Method in class lejos.nxt.addon.RFIDSensor
Start the firmware on the RFID device.
startMotor(int) - Method in class lejos.nxt.addon.RCXLink
 
startMotors() - Method in class lejos.nxt.addon.NXTMMX
Starts both motors at the same time.
startPage - Variable in class lejos.nxt.remote.FileInfo
The start page of the file in flash memory.
startPathFinding(Pose, WayPoint) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder
 
startPathFinding(Pose, WayPoint) - Method in class lejos.robotics.pathfinding.NodePathFinder
 
startPathFinding(Pose, WayPoint) - Method in interface lejos.robotics.pathfinding.PathFinder
 
startPathFinding(Pose, WayPoint) - Method in class lejos.robotics.pathfinding.RandomPathFinder
 
startPathFinding(Pose, WayPoint) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
startProgram(String) - Static method in class lejos.nxt.FileSystem
Starts a Lego executable file on the NXT.
startProgram(String) - Method in class lejos.nxt.remote.NXTCommand
Starts a program already on the NXT.
startSingleRead() - Method in class lejos.nxt.addon.RFIDSensor
Start a single read from the device.
status - Variable in class lejos.nxt.remote.DeviceInfo
 
status - Variable in class lejos.nxt.remote.FileInfo
The status of the file - not used.
status - Variable in class lejos.nxt.remote.FirmwareInfo
 
status - Variable in class lejos.nxt.remote.OutputState
 
steer(double) - Method in class lejos.robotics.navigation.DifferentialPilot
Starts the robot moving forward along a curved path.
steer(double, double) - Method in class lejos.robotics.navigation.DifferentialPilot
Moves the robot along a curved path through a specified turn angle.
steer(double, double, boolean) - Method in class lejos.robotics.navigation.DifferentialPilot
Moves the robot along a curved path for a specified angle of rotation.
steer(int) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Starts the robot moving along a curved path.
steer(int, int) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Moves the robot along a curved path through a specified turn angle.
steer(int, int, boolean) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Moves the robot along a curved path for a specified angle of rotation.
steer(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
steer(float, float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
steer(float, float, boolean) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
steerBackward(double) - Method in class lejos.robotics.navigation.DifferentialPilot
Starts the robot moving backward along a curved path.
SteeringPilot - Class in lejos.robotics.navigation
Vehicles that are controlled by the SteeringPilot class use a similar steering mechanism to a car, in which the front wheels pivot from side to side to control direction.
SteeringPilot(double, RegulatedMotor, boolean, RegulatedMotor, double, int, int) - Constructor for class lejos.robotics.navigation.SteeringPilot
Creates an instance of the SteeringPilot.
steerPrep(double) - Method in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this method will be private in NXJ version 1.0 when the CompassPilot is removed.
steerPrep(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. helper method used by steer(float) and steer(float,float,boolean)
stop(boolean) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Causes motor to stop pretty much instantaneously.
stop() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Causes motor to stop pretty much instantaneously.
stop() - Method in class lejos.nxt.addon.NXTMMXMotor
stops the motor
stop() - Method in class lejos.nxt.addon.PFMateMotor
Stops the Motor
stop() - Method in class lejos.nxt.addon.RFIDSensor
Send a stop command to the device.
stop() - Method in class lejos.nxt.BasicMotor
Causes motor to stop, pretty much instantaneously.
STOP - Static variable in interface lejos.nxt.BasicMotorPort
Motor is stopped (PWM drive still applied)
stop(boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
stop() - Method in class lejos.nxt.remote.RemoteMotor
 
stop() - Method in interface lejos.robotics.BaseMotor
Causes motor to stop immediately.
stop() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Stops the robot soon after the method is executed.
stop() - Method in class lejos.robotics.navigation.DifferentialPilot
Stops the NXT robot.
stop() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Stops the robot.
stop() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. Stops the NXT robot.
stop() - Method in interface lejos.robotics.navigation.MoveController
Halts the NXT robot
stop() - Method in class lejos.robotics.navigation.SteeringPilot
 
stop(boolean) - Method in interface lejos.robotics.RegulatedMotor
Causes motor to stop, pretty much instantaneously.
STOP_ALL_PROGRAMS - Static variable in class lejos.nxt.addon.RCXLink
 
STOP_PROGRAM - Static variable in interface lejos.nxt.remote.NXTProtocol
 
STOP_SOUND_PLAYBACK - Static variable in interface lejos.nxt.remote.NXTProtocol
 
stopActuator() - Method in class lejos.nxt.addon.LinearActuator
Immediately stop any current actuator action.
stopAllPrograms() - Method in class lejos.nxt.addon.IRLink
 
stopAllPrograms() - Method in interface lejos.nxt.addon.IRTransmitter
 
stopAllPrograms() - Method in class lejos.nxt.addon.RCXLink
 
stopCalibration() - Method in class lejos.nxt.addon.CompassSensor
Ends calibration sequence.
stopCalibration() - Method in class lejos.nxt.addon.GyroDirectionFinder
NO FUNCTIONALITY EQUIVALENT for GyroSensor so implemented just to satisfy the DirectionFinder interface.
stopCalibration() - Method in interface lejos.robotics.DirectionFinder
Ends calibration sequence.
stopMotor(int) - Method in class lejos.nxt.addon.RCXLink
 
stopMotors() - Method in class lejos.nxt.addon.NXTMMX
Stops both motors
stopNow() - Method in class lejos.robotics.navigation.CompassPilot
Deprecated.  
stopProgram() - Static method in class lejos.nxt.FileSystem
Stops the currently running Lego executable on the NXT.
stopProgram() - Method in class lejos.nxt.remote.NXTCommand
Forces the currently executing program to stop.
stopSoundPlayback() - Method in class lejos.nxt.remote.NXTCommand
Stops sound file playing.
stopSoundPlayback() - Static method in class lejos.nxt.Sound
Stops a sound file that has been playing/repeating.
Stopwatch - Class in lejos.util
Elapsed time watch (in milliseconds)
To use - construct a new instance.
Stopwatch() - Constructor for class lejos.util.Stopwatch
 
storePersistentValues() - Method in class lejos.util.PilotProps
 
stripColons(String) - Method in class lejos.pc.comm.NXTCommBluecove
 
subtract(Point) - Method in class lejos.geom.Point
 
subtract(float) - Method in class lejos.geom.Point
 
subtractWith(Point) - Method in class lejos.geom.Point
 
SUCCESS - Static variable in interface lejos.nxt.remote.ErrorMessages
 
SWITCH - Static variable in interface lejos.nxt.remote.NXTProtocol
 
SYSTEM_COMMAND_NOREPLY - Static variable in interface lejos.nxt.remote.NXTProtocol
 
SYSTEM_COMMAND_REPLY - Static variable in interface lejos.nxt.remote.NXTProtocol
 
SystemContext - Class in lejos.pc.comm
Deprecated. will be replaced
SystemContext() - Constructor for class lejos.pc.comm.SystemContext
Deprecated.  

T

T1 - Variable in class lejos.nxt.addon.TouchMUX
Instance for the touch sensor connected to port T1
T2 - Variable in class lejos.nxt.addon.TouchMUX
Instance for the touch sensor connected to port T2
T3 - Variable in class lejos.nxt.addon.TouchMUX
Instance for the touch sensor connected to port T3
tachoCount - Variable in class lejos.nxt.remote.OutputState
 
tachoLimit - Variable in class lejos.nxt.remote.OutputState
 
Tachometer - Interface in lejos.nxt
Abstraction for the tachometer built into NXT motors.
Tachometer - Interface in lejos.robotics
Abstraction for a Tachometer, which monitors speed of the encoder.
TachoMotorPort - Interface in lejos.nxt
Abstraction for a motor port that supports NXT motors with tachometers.
targetListeners - Variable in class lejos.robotics.navigation.NavPathController
 
TEMPERATURE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
times(double) - Method in class lejos.util.Matrix
Multiply a matrix by a scalar, C = s*A
times(Matrix) - Method in class lejos.util.Matrix
Linear algebraic matrix multiplication, A * B
timesEquals(double) - Method in class lejos.util.Matrix
Multiply a matrix by a scalar in place, A = s*A
toString() - Method in class lejos.nxt.addon.IRSeekerV2
Returns a string representation of the strengths
toString() - Method in class lejos.robotics.navigation.Pose
return string contains x,y and headint
toString() - Method in class lejos.robotics.pathfinding.AstarSearchAlgorithm
 
toString() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
toString() - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
Touch - Interface in lejos.robotics
Abstraction for touch sensors
TouchFeatureDetector - Class in lejos.robotics.objectdetection
This class allows a touch sensor to be used as a defacto range sensor by reporting the position of the touch sensor to the object detection API.
TouchFeatureDetector(Touch) - Constructor for class lejos.robotics.objectdetection.TouchFeatureDetector
Creates a touch detector in which the touch sensor is assumed to be situated in the center of the robot.
TouchFeatureDetector(Touch, double, double) - Constructor for class lejos.robotics.objectdetection.TouchFeatureDetector
If you want the bumpers to report contact relative to the geometry of where they are placed on the robot, you can provide the x, y offsets of each bumper relative to the center of the robot (the center is the halfway point between the drive wheels).
TouchMUX - Class in lejos.nxt.addon
Interface for the Mindsensors Touch Multiplexer.
TouchMUX(ADSensorPort) - Constructor for class lejos.nxt.addon.TouchMUX
Create a object to provide access to a touch sensor multiplexer
TouchSensor - Class in lejos.nxt
Abstraction for a NXT touch sensor.
TouchSensor(ADSensorPort) - Constructor for class lejos.nxt.TouchSensor
Create a touch sensor object attached to the specified port.
trace() - Method in class lejos.util.Matrix
Matrix trace.
TRANSITIONCNTMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
translate(float, float) - Method in class lejos.geom.Point
Translates this point, at location (x, y), by dx along the x axis and dy along the y axis so that it now represents the point (x + dx, y + dy).
translate(float, float) - Method in class lejos.robotics.navigation.Pose
Change the x and y coordinates of the pose by adding dx and dy.
transpose() - Method in class lejos.util.Matrix
Matrix transpose.
travel(float, boolean) - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Moves the NXT robot a specific distance.
travel(float) - Method in class lejos.robotics.navigation.CompassPilot
Deprecated. Moves the NXT robot a specific distance;
A positive distance causes forward motion; negative distance moves backward.
travel(double) - Method in class lejos.robotics.navigation.DifferentialPilot
Moves the NXT robot a specific distance in an (hopefully) straight line.
A positive distance causes forward motion, a negative distance moves backward.
travel(double, boolean) - Method in class lejos.robotics.navigation.DifferentialPilot
Moves the NXT robot a specific distance in an (hopefully) straight line.
A positive distance causes forward motion, a negative distance moves backward.
travel(float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Moves the NXT robot a specific distance.
travel(float, boolean) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Moves the NXT robot a specific distance.
travel(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. Moves the NXT robot a specific distance in an (hopefully) straight line.
A positive distance causes forward motion, a negative distance moves backward.
travel(float, boolean) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. Moves the NXT robot a specific distance in an (hopefully) straight line.
A positive distance causes forward motion, a negative distance moves backward.
travel(double) - Method in interface lejos.robotics.navigation.MoveController
Moves the NXT robot a specific distance.
travel(double, boolean) - Method in interface lejos.robotics.navigation.MoveController
Moves the NXT robot a specific distance.
travel(double) - Method in class lejos.robotics.navigation.SteeringPilot
 
travel(double, boolean) - Method in class lejos.robotics.navigation.SteeringPilot
 
travelArc(double, double) - Method in interface lejos.robotics.navigation.ArcMoveController
Moves the NXT robot a specified distance along an arc of specified radius, after which the robot stops moving.
travelArc(double, double, boolean) - Method in interface lejos.robotics.navigation.ArcMoveController
Moves the NXT robot a specified distance along an arc of specified radius, after which the robot stops moving.
travelArc(double, double) - Method in class lejos.robotics.navigation.DifferentialPilot
 
travelArc(double, double, boolean) - Method in class lejos.robotics.navigation.DifferentialPilot
 
travelArc(float, float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Moves the NXT robot in a circular arc through a specific distance;
The center of the turning circle is on the left side of the robot if parameter radius is positive and on the right if negative.
travelArc(float, float, boolean) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated. Moves the NXT robot in a circular arc through a specific distance;
The center of the turning circle is on the left side of the robot if parameter radius is positive and on the right if negative.
travelArc(float, float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
travelArc(float, float, boolean) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
travelArc(double, double) - Method in class lejos.robotics.navigation.SteeringPilot
 
travelArc(double, double, boolean) - Method in class lejos.robotics.navigation.SteeringPilot
 
turnRatio - Variable in class lejos.nxt.remote.OutputState
 
turnRatio - Variable in class lejos.nxt.remote.RemoteMotor
 
type - Variable in class lejos.nxt.ColorSensor
 
TYPE_ANGLE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_COLORBLUE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_COLORFULL - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_COLORGREEN - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_COLORNONE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_COLORRED - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_CUSTOM - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_HISPEED - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LIGHT_ACTIVE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LIGHT_INACTIVE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LOWSPEED - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LOWSPEED_9V - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_NO_SENSOR - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_REFLECTION - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_SOUND_DB - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_SOUND_DBA - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_SWITCH - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_TEMPERATURE - Static variable in interface lejos.nxt.SensorConstants
 

U

UltrasonicSensor - Class in lejos.nxt
Abstraction for a NXT Ultrasonic Sensor.
UltrasonicSensor(I2CPort) - Constructor for class lejos.nxt.UltrasonicSensor
 
uminus() - Method in class lejos.util.Matrix
Unary minus
UNDEFINED_ERROR - Static variable in interface lejos.nxt.remote.ErrorMessages
 
UNKNOWN - Static variable in class lejos.util.jni.OSInfo
 
UNKNOWN_COMMAND_OPCODE - Static variable in interface lejos.nxt.remote.ErrorMessages
 
unload() - Method in class lejos.nxt.addon.LMotor
 
unloadAllServos() - Method in class lejos.nxt.addon.LSC
Unload all servos connected in a LSC
unlockAllPages() - Method in class lejos.pc.comm.NXTSamba
Turn off the lock bits for all of flash memory.
unproject(Point, Point) - Method in class lejos.geom.Point
 
unProjectWith(Point) - Method in class lejos.geom.Point
 
unProjectWith(Point, Point) - Method in class lejos.geom.Point
 
update() - Method in class lejos.nxt.addon.PFMate
Sends command to PF IR receiver to apply changes made to the registers.
update() - Method in class lejos.robotics.localization.MCLPoseProvider
Calls range scanner to get range readings, calculates the probabilities of each particle from the range readings and the map and calls resample(()
update(RangeReadings) - Method in class lejos.robotics.localization.MCLPoseProvider
Calculates particle weights from readings, then resamples the particle set;
update(Matrix, Matrix) - Method in class lejos.util.KalmanFilter
 
UPDATE_TIME - Static variable in class lejos.nxt.addon.RCXRotationSensor
 
updatePose() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
updateState(int) - Method in class lejos.nxt.BasicMotor
Update the internal state tracking the motor direction
upload(File) - Static method in class lejos.nxt.FileSystem
 
uploadFile(File, String) - Method in class lejos.nxt.remote.NXTCommand
Upload a file to the NXT
USB - Static variable in class lejos.pc.comm.NXTCommFactory
 
usDelay(long) - Static method in class lejos.util.Delay
Wait for the specified number of microseconds.

V

valid - Variable in class lejos.nxt.remote.InputValues
NXT indicates if it thinks the data is valid
valueOf(String) - Static method in enum lejos.nxt.addon.IRSeekerV2.Mode
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.NXTLineLeader.Command
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.NXTLineLeader.LineColor
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.pc.comm.NXTConnectionState
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.robotics.navigation.Move.MoveType
Returns the enum constant of this type with the specified name.
values() - Static method in enum lejos.nxt.addon.IRSeekerV2.Mode
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum lejos.nxt.addon.NXTLineLeader.Command
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum lejos.nxt.addon.NXTLineLeader.LineColor
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum lejos.pc.comm.NXTConnectionState
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum lejos.robotics.navigation.Move.MoveType
Returns an array containing the constants of this enum type, in the order they are declared.

W

waitComplete() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Wait until the current movement operation is complete.
waitComplete() - Method in class lejos.nxt.remote.RemoteMotor
 
waitComplete() - Method in interface lejos.robotics.RegulatedMotor
Wait until the current movement operation is complete (this can include the motor stalling).
waitForDestinationReached() - Method in class lejos.robotics.navigation.NavPathController
 
waitTillSent() - Static method in class lejos.nxt.rcxcomm.Serial
Wait until the packet is sent - null
wakeUp() - Method in class lejos.nxt.addon.NXTLineLeader
Wake up the sensor
wakeUp() - Method in class lejos.nxt.addon.RFIDSensor
The sensor will go into a power save mode after a short time.
WayPoint - Class in lejos.robotics.navigation
A sequence of way points make up a route that a robot can navigate.
WayPoint(double, double) - Constructor for class lejos.robotics.navigation.WayPoint
 
WayPoint(double, double, double) - Constructor for class lejos.robotics.navigation.WayPoint
 
WayPoint(Point) - Constructor for class lejos.robotics.navigation.WayPoint
 
WayPoint(Pose) - Constructor for class lejos.robotics.navigation.WayPoint
 
WayPointListener - Interface in lejos.robotics.navigation
Interface for informing listeners that a way point has been reached.
WHEEL_SIZE_NXT1 - Static variable in interface lejos.robotics.navigation.MoveController
NXT 1.0 kit wheel diameter, in centimeters
WHEEL_SIZE_NXT2 - Static variable in interface lejos.robotics.navigation.MoveController
NXT 2.0 kit wheel diameter, in centimeters
WHEEL_SIZE_RCX - Static variable in interface lejos.robotics.navigation.MoveController
White RCX "motorcycle" wheel diameter, in centimeters
WHITE - Static variable in interface lejos.nxt.SensorConstants
 
WHITE - Static variable in class lejos.robotics.Color
 
WRITE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
write(byte[]) - Method in interface lejos.pc.comm.NXTComm
Write data to a NXT that has an open connection.
write(byte[]) - Method in class lejos.pc.comm.NXTCommBluecove
 
write(byte[]) - Method in class lejos.pc.comm.NXTCommBluez
 
write(int) - Method in class lejos.pc.comm.NXTCommOutputStream
 
write(byte[]) - Method in class lejos.pc.comm.NXTCommUSB
Write bytes to the device.
writeBytes(int, byte[]) - Method in class lejos.pc.comm.NXTSamba
Write a series of bytes to the device.
writeFile(byte, byte[]) - Method in class lejos.nxt.remote.NXTCommand
Write data to the file
writeHalfword(int, int) - Method in class lejos.pc.comm.NXTSamba
Write a 16 bit halfword to the specified address.
writeOctet(int, int) - Method in class lejos.pc.comm.NXTSamba
Write a 8 bit octet to the specified address.
writePage(int, byte[], int) - Method in class lejos.pc.comm.NXTSamba
Write a single page to flash memory.
writePage(int, byte[], int, int) - Method in class lejos.pc.comm.NXTSamba
Write a single page to flash memory.
writePages(int, byte[], int, int) - Method in class lejos.pc.comm.NXTSamba
Write a series of pages to flash memory.
writeWord(int, int) - Method in class lejos.pc.comm.NXTSamba
Write a 32 bit word to the specified address.

X

x - Variable in class lejos.robotics.pathfinding.Node
The x coordinate of this node.
xOffset - Variable in class lejos.pc.comm.MapPanel
 

Y

y - Variable in class lejos.robotics.pathfinding.Node
The y coordinate of this node.
YELLOW - Static variable in interface lejos.nxt.SensorConstants
 
YELLOW - Static variable in class lejos.robotics.Color
 
yOffset - Variable in class lejos.pc.comm.MapPanel
 

Z

ZERO - Variable in class lejos.robotics.FixedRangeScanner
 
ZERO - Variable in class lejos.robotics.RotatingRangeScanner
 

_

_blocked - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder
set by segmentBlocked() used by findPath()
_blocked - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
_blocked - Variable in class lejos.robotics.pathfinding.ShortestPathFinder
set by segmentBlocked() used by findPath()
_blocked - Variable in class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
_candidate - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder
the set of nodes that are candidates for being in the shortest path, but whose distance from the start node is not yet known
_candidate - Variable in class lejos.robotics.pathfinding.ShortestPathFinder
the set of nodes that are candidates for being in the shortest path, but whose distance from the start node is not yet known
_count - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder
 
_count - Variable in class lejos.robotics.pathfinding.ShortestPathFinder
 
_destination - Variable in class lejos.robotics.navigation.NavPathController
 
_direction - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
_distance - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
_estimatedHeading - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
_heading - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
_heading - Variable in class lejos.robotics.navigation.Pose
 
_heading0 - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
_inside - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. The motor at the inside of the turn.
_keepGoing - Variable in class lejos.robotics.navigation.NavPathController
 
_left - Variable in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this field will be private in NXJ version 1.0 when the CompassPilot is removed.
_left - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Left motor.
_leftDegPerDistance - Variable in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this field will be private in NXJ version 1.0 when the CompassPilot is removed.
_leftDegPerDistance - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Left motor degrees per unit of travel.
_leftTurnRatio - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Left motor revolutions for 360 degree rotation of robot (motors running in opposite directions).
_leftWheelDiameter - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Diameter of left wheel.
_location - Variable in class lejos.robotics.navigation.Pose
 
_map - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder
The map of the obstacles
_map - Variable in class lejos.robotics.pathfinding.ShortestPathFinder
The map of the obstacles
_motorSpeed - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Motor speed degrees per second.
_nav - Variable in class lejos.robotics.navigation.NavPathController
 
_outside - Variable in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this field will be private in NXJ version 1.0 when the CompassPilot is removed.
_outside - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. The motor at the outside of the turn.
_p - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
_p - Variable in class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
_pilot - Variable in class lejos.robotics.navigation.NavPathController
 
_pose - Variable in class lejos.robotics.navigation.NavPathController
 
_predecessor - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
_predecessor - Variable in class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
_radius - Variable in class lejos.robotics.navigation.NavPathController
 
_reached - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder
the set of nodes that are candidates for being in the shortest path, and whose distance from the start node is known
_reached - Variable in class lejos.robotics.pathfinding.ShortestPathFinder
the set of nodes that are candidates for being in the shortest path, and whose distance from the start node is known
_right - Variable in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this field will be private in NXJ version 1.0 when the CompassPilot is removed.
_right - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Right motor.
_rightDegPerDistance - Variable in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this field will be private in NXJ version 1.0 when the CompassPilot is removed.
_rightDegPerDistance - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Right motor degrees per unit of travel.
_rightTurnRatio - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Right motor revolutions for 360 degree rotation of robot (motors running in opposite directions).
_rightWheelDiameter - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Diameter of right wheel.
_robotRotateSpeed - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Speed of robot for turning in degree per seconds.
_robotTravelSpeed - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Speed of robot for moving in wheel diameter units per seconds.
_route - Variable in class lejos.robotics.navigation.NavPathController
 
_sourceDistance - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
_sourceDistance - Variable in class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
_steerRatio - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. ratio of inside/outside motor speeds set by steer(turnRate) used by other steer methods;
_trackWidth - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Distance between wheels.
_traveling - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
_type - Variable in class lejos.robotics.navigation.DifferentialPilot
Deprecated. Access to this field will be private in NXJ version 1.0 when the CompassPilot is removed.

A B C D E F G H I J K L M N O P R S T U V W X Y Z _