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

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
 
about - Variable in class lejos.robotics.mapping.NavigationPanel
 
about() - Method in class lejos.robotics.mapping.NavigationPanel
Provides a pop up about dialog which can be tailored or overridden
aboutMenu - Variable in class lejos.robotics.mapping.NavigationPanel
 
AbstractCommandLineParser - Class in lejos.pc.tools
 
AbstractCommandLineParser(Class<?>, String) - Constructor for class lejos.pc.tools.AbstractCommandLineParser
 
AbstractTool - Class in js.common
Abstract tool.
AbstractTool() - Constructor for class js.common.AbstractTool
Constructor.
ACCEL - Static variable in class lejos.nxt.addon.DIMUAccel
 
Accelerometer - Interface in lejos.robotics
Interface for Acceleration sensors
AccelHTSensor - Class in lejos.nxt.addon
Class to access the HiTechnic NXT Acceleration / Tilt Sensor (NAC1040).
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 ACCL-Nx-v2/v3.
AccelMindSensor(I2CPort) - Constructor for class lejos.nxt.addon.AccelMindSensor
 
AccelMindSensor(I2CPort, int) - Constructor for class lejos.nxt.addon.AccelMindSensor
 
accelUnit - Variable in class lejos.nxt.addon.DIMUAccel
The default unit to use when retuning acceleration data from the accelerometer
action() - Method in interface lejos.robotics.subsumption.Behavior
The code in action() represents the tasks the robot performs when this behavior becomes active.
actionPerformed(ActionEvent) - Method in class lejos.pc.tools.NXJConsoleViewer
Required by action listener.
actionPerformed(ActionEvent) - Method in class lejos.pc.tools.NXJDataViewer
Required by action listener
actionPerformed(ActionEvent) - Method in class lejos.pc.tools.NXJMonitor
 
actionPerformed(ActionEvent) - Method in class lejos.robotics.mapping.EventPanel
 
actionPerformed(ActionEvent) - Method in class lejos.robotics.mapping.MenuAction
 
actionPerformed(ActionEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Called when a menu item is selected or button clicked
actionPerformed(ActionEvent) - Method in class lejos.robotics.mapping.SliderPanel
 
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(T) - Method in class js.tinyvm.RecordTable
Add a writable element.
add(Point) - Method in class lejos.geom.Point
Returns the vector sum of this and other
addClassRecord(String, ClassRecord) - Method in class js.tinyvm.Binary
Add a class.
addCommentMarker(double, String) - Method in class lejos.pc.charting.CustomChartPanel
Add a comment marker to the chart at specified domain position.
addDataPoints(double[]) - Method in class lejos.pc.charting.CustomChartPanel
Add series data to the dataset.
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.
addElement(T) - Method in class js.tinyvm.util.HashVector
 
addInterfaces(ClassRecord) - Method in class js.tinyvm.ClassRecord
 
addInterfaces(ClassRecord) - Method in class js.tinyvm.PrimitiveClassRecord
 
addInterfaceUser(ClassRecord) - Method in class js.tinyvm.ClassRecord
 
addListener(RegulatedMotorListener) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Add a single motor listener.
addListener(RegulatedMotorListener) - Method in class lejos.nxt.remote.RemoteMotor
Currently not completely implemented in RemoteMotor!
addListener(RegulatedMotorListener) - Method in class lejos.robotics.MirrorMotor
 
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
addLoggerListener(LoggerListener) - Method in class lejos.pc.charting.LoggerProtocolManager
Register a LoggerListener so data can be managed and acted upon when it is received from the NXT.
addLogListener(NXTCommLogListener) - Method in class lejos.pc.comm.NXTCommLoggable
register log listener
addLogListener(NXTCommLogListener) - Method in class lejos.pc.comm.NXTConnectionManager
register log listener
addLogListener(ToolsLogListener) - Method in class lejos.pc.tools.NXJUpload
Register log listener
addLogListener(ToolsLogListener) - Method in class lejos.pc.tools.Upload
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.OmniPilot
 
addMoveListener(MoveListener) - Method in class lejos.robotics.navigation.SteeringPilot
 
addNavigationListener(NavigationListener) - Method in class lejos.robotics.navigation.Navigator
Adds a NavigationListener that is informed when a the robot stops or reaches a WayPoint.
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.
addProgressMonitor(ToolProgressMonitor) - Method in class js.common.AbstractTool
register progress monitor
addProgressMonitor(ToolProgressMonitor) - Method in class lejos.pc.tools.NXJLink
Register log listener
addReading(double) - Method in class lejos.util.Integration
Add a new reading and return the current integral
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
addToolsLogListener(ToolsLogListener) - Method in class lejos.pc.tools.NXJLinkAndUpload
Register log listener
addUsedMethod(String) - Method in class js.tinyvm.ClassRecord
 
addUsedMethod(String) - Method in class js.tinyvm.PrimitiveClassRecord
 
addWaypoint(Waypoint) - Method in class lejos.robotics.mapping.PCNavigationModel
Add a waypoint and send it to the NXT
addWaypoint(Waypoint) - Method in class lejos.robotics.navigation.Navigator
Adds a Waypoint to the end of the path.
addWaypoint(float, float) - Method in class lejos.robotics.navigation.Navigator
Constructs an new Waypoint from the parameters and adds it to the end of the path.
addWaypoint(float, float, float) - Method in class lejos.robotics.navigation.Navigator
Constructs an new Waypoint from the parameters and adds it to the end of the path.
addWaypoint(Waypoint) - Method in interface lejos.robotics.navigation.WaypointListener
Called when the class providing waypoints generates a new waypoint.
addWith(Point) - Method in class lejos.geom.Point
Vector addition; add other to this
adjustedSize(int, int) - Static method in class js.tinyvm.io.IOUtilities
Size in bytes corrected to record boundaries.
ADSensorPort - Interface in lejos.nxt
An abstraction for a port that supports Analog/Digital sensors.
alg - Variable in class lejos.robotics.mapping.PCNavigationModel
 
ALL_PROTOCOLS - Static variable in class lejos.pc.comm.NXTCommFactory
Use either USB or Bluetooth for the connection.
allChannelsOff() - Method in class lejos.nxt.addon.RCXSensorMultiplexer
Turns off all channels
allocateComponents() - Method in class lejos.pc.tools.NXJImageCodePanel
 
allocateComponents() - Method in class lejos.pc.tools.NXJImagePicturePanel
 
ALWAYS_ACTIVE - Static variable in interface lejos.nxt.I2CPort
 
angle() - Method in class lejos.geom.Point
returns the angle in radians of this point from the origin.
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) - 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(String) - Method in class lejos.pc.tools.ConsoleViewerSwingUI
Append data to the log display
append(String) - Method in interface lejos.pc.tools.ConsoleViewerUI
 
append(float) - Method in interface lejos.pc.tools.DataViewerUI
 
append(String) - Method in class lejos.pc.tools.NXJConsole
 
append(String) - Method in class lejos.pc.tools.NXJConsoleViewer
 
append(float) - Method in class lejos.pc.tools.NXJControl
Append data item to the data log
append(String) - Method in class lejos.pc.tools.NXJControl
Used by console viewer
append(float) - Method in class lejos.pc.tools.NXJDataViewer
Append float to the data log display
APPEND_NOT_POSSIBLE - Static variable in class 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
Arbitrator - Class in lejos.robotics.subsumption
Arbitrator controls which Behavior object will become active in a behavior control system.
Arbitrator(Behavior[], boolean) - Constructor for class lejos.robotics.subsumption.Arbitrator
Allocates an Arbitrator object and initializes it with an array of Behavior objects.
Arbitrator(Behavior[]) - Constructor for class lejos.robotics.subsumption.Arbitrator
Same as Arbitrator(behaviorList, false) Arbitrator start() never exits
arc(float, float) - Method in class lejos.robotics.mapping.PCNavigationModel
Send an ARC event to the NXT
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.OmniPilot
 
arc(double, double, double) - Method in class lejos.robotics.navigation.OmniPilot
This method moves the robot in an arc, similar to the other OmniPilot.arc(double, double) methods, except you can choose any of the 360 degree directions relative to the current heading (0) of the robot, while keeping the heading of the robot pointed in the same direction during the move.
arc(double, double, boolean) - Method in class lejos.robotics.navigation.OmniPilot
 
arc(double, double, double, boolean) - Method in class lejos.robotics.navigation.OmniPilot
This method moves the robot in an arc, similar to the other OmniPilot.arc(double, double) methods, except you can choose any of the 360 degree directions relative to the current heading (0) of the robot, while keeping the heading of the robot pointed in the same direction during the move.
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.OmniPilot
 
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.OmniPilot
 
arcForward(double) - Method in class lejos.robotics.navigation.SteeringPilot
 
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 location and heading to the correct values resulting from travel in a circular arc.
ARRAY_HEADER - Static variable in class js.tinyvm.TinyVMConstants
 
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
 
ARROW_LENGTH - Static variable in class lejos.robotics.mapping.MapPanel
 
arrowLength - Variable in class lejos.robotics.mapping.MapPanel
 
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
 
asyncRefresh() - Static method in class lejos.nxt.LCD
 
asyncRefreshWait() - Static method in class lejos.nxt.LCD
 
atEndOfLine(Line) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
test if this Node is one of the ends of theLine
ATTEMPTED_TO_ACCESS_INVALID_FIELD_OF_A_STRUCTURE - Static variable in class lejos.nxt.remote.ErrorMessages
 
atWaypoint(Waypoint, Pose, int) - Method in interface lejos.robotics.navigation.NavigationListener
Called when the robot has reached a new Wahpoint.
available() - Method in class lejos.pc.charting.CachingInputStream
 
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.
axisChanged(AxisChangeEvent) - Method in class lejos.pc.charting.CustomChartPanel
 

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
 
BACKGROUND_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
BACKGROUND_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
backgroundColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
backward() - Method in class lejos.nxt.addon.LServo
Classic backward method for continous RC Servos
backward() - Method in class lejos.nxt.addon.MMXMotor
Causes motor to rotate backwards.
backward() - Method in class lejos.nxt.addon.MMXRegulatedMotor
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.MirrorMotor
 
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.OmniPilot
 
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 class lejos.nxt.remote.ErrorMessages
 
BAD_INPUT_OR_OUTPUT_SPECIFIED - Static variable in class lejos.nxt.remote.ErrorMessages
 
Ballbot - Class in lejos.robotics.navigation
This class dynamically stabilizes a ballbot type of robot.
Ballbot(EncoderMotor, Gyroscope, EncoderMotor, Gyroscope, double) - Constructor for class lejos.robotics.navigation.Ballbot
 
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.
BEByteWriter - Class in js.tinyvm.io
 
BEByteWriter(OutputStream) - Constructor for class js.tinyvm.io.BEByteWriter
 
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
 
beep() - Static method in class lejos.nxt.Sound
Beeps once.
beepSequence() - Static method in class lejos.nxt.Sound
Downward tones.
beepSequenceUp() - Static method in class lejos.nxt.Sound
Upward tones.
Behavior - Interface in lejos.robotics.subsumption
The Behavior interface represents an object embodying a specific behavior belonging to a robot.
Binary - Class in js.tinyvm
Abstraction for dumped binary.
Binary(boolean) - Constructor for class js.tinyvm.Binary
Constructor.
BinaryReport - Class in js.tinyvm
Class for creating a report of a binary.
BinaryReport(Binary) - Constructor for class js.tinyvm.BinaryReport
Constructor.
BIT_16 - Static variable in class lejos.pc.tools.NXJImageConverter
 
BIT_8 - Static variable in class lejos.pc.tools.NXJImageConverter
 
bitBlt(byte[], int, int, int, int, int, int, int, int, int) - Static method in class lejos.nxt.LCD
Standard two input BitBlt function with the LCD display as the destination.
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 - Static variable in class lejos.util.TextMenu
a blank line
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
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
Use Bluetooth for the connection
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
 
borderField - Variable in class lejos.robotics.mapping.NavigationPanel
 
borderLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
BRAKE - Static variable in interface lejos.nxt.remote.NXTProtocol
Use run/brake instead of run/float in PWM
buildGui() - Method in class lejos.pc.tools.NXJConsoleViewer
 
buildGUI() - Method in class lejos.pc.tools.NXJMapCommand
Build the specific GUI for this application
buildGUI() - Method in class lejos.robotics.mapping.NavigationPanel
Build the GUI- used by MCLTest but deprecated
buildPanels() - Method in class lejos.robotics.mapping.NavigationPanel
Build all the panels
Button - Class in lejos.nxt
PC emulation of the Button class
button - Variable in class lejos.robotics.mapping.SliderPanel
 
BUTTON_POLL_INTERVAL - Static variable in class lejos.util.TextMenu
Timout used for Button.waitForAnyPress(int) in TextMenu.select(int, int).
buzz() - Static method in class lejos.nxt.Sound
Low buzz
BYTEA - Static variable in class lejos.pc.tools.NXJImageConverter
 
bytesAvailable() - Method in class lejos.nxt.addon.RCXLink
 
ByteWriter - Class in js.tinyvm.io
Basic byte writer implementation (write order independant part)
ByteWriter(OutputStream) - Constructor for class js.tinyvm.io.ByteWriter
Constructor.

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
 
C2 - Static variable in class lejos.nxt.Sound
 
C_ARRAY - Static variable in class js.tinyvm.TinyVMConstants
 
C_HASCLINIT - Static variable in class js.tinyvm.TinyVMConstants
 
C_INITIALIZED - Static variable in class js.tinyvm.TinyVMConstants
 
C_INTERFACE - Static variable in class js.tinyvm.TinyVMConstants
 
C_NOREFS - Static variable in class js.tinyvm.TinyVMConstants
 
C_PRIMITIVE - Static variable in class js.tinyvm.TinyVMConstants
 
CachingInputStream - Class in lejos.pc.charting
Provide a read-ahead buffer input stream of bytes.
CachingInputStream(InputStream, int) - Constructor for class lejos.pc.charting.CachingInputStream
Construct an CachingInputStream with the specified buffer size and source.
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.
calculateOffset() - Method in class lejos.nxt.addon.DIMUGyro
Calibrates the sensor
calculatePath - Variable in class lejos.robotics.mapping.NavigationPanel
 
calculatePath() - Method in class lejos.robotics.mapping.PCNavigationModel
Calculate the path with the Node path finder
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.
calibrateAxis(char) - Method in class lejos.nxt.addon.DIMUAccel
Calibrates a single axis.
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
calibrateSteering() - Method in class lejos.robotics.navigation.SteeringPilot
This method calibrates the steering mechanism by turning the wheels all the way to the right and left until they encounter resistance and recording the tachometer values.
caller - Variable in class lejos.pc.tools.AbstractCommandLineParser
 
capture() - Method in class lejos.nxt.UltrasonicSensor
Set capture mode Set the sensor into capture mode.
CELL_HEIGHT - Static variable in class lejos.nxt.LCD
 
CELL_WIDTH - Static variable in class lejos.nxt.LCD
 
CELSIUSMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
CENTER - Static variable in class lejos.nxt.addon.SumoEyesSensor
The Constant CENTER (2).
chartChanged(ChartChangeEvent) - Method in class lejos.pc.charting.CustomChartPanel
 
ChartingLogger - Class in lejos.pc.charting
Swing application entry point for NXT Charting Logger GUI client
ChartingLogger() - Constructor for class lejos.pc.charting.ChartingLogger
 
chartProgress(ChartProgressEvent) - Method in class lejos.pc.charting.CustomChartPanel
 
checkFile(File) - Method in class lejos.robotics.mapping.PCNavigationModel
Check that the file exists on the NXT with the right size
checkValidity(Pose) - Method in class lejos.robotics.navigation.Waypoint
Check that the given pose satisfies the conditions for this way point
chooser - Variable in class lejos.robotics.mapping.NavigationPanel
 
CLASSES - Static variable in class js.tinyvm.SpecialConstants
 
ClassPath - Class in js.tinyvm
Class path.
ClassPath(String) - Constructor for class js.tinyvm.ClassPath
Constructor.
ClassRecord - Class in js.tinyvm
Abstraction for a class record (see vmsrc/language.h).
ClassRecord() - Constructor for class js.tinyvm.ClassRecord
 
clear() - Static method in class lejos.nxt.LCD
 
clear(int) - Static method in class lejos.nxt.LCD
 
clear() - Method in class lejos.pc.tools.LCDDisplay
 
clear - Variable in class lejos.robotics.mapping.NavigationPanel
 
clear() - Method in class lejos.robotics.mapping.PCNavigationModel
Clear all variable data
clear() - Method in class lejos.util.DebugMessages
Clear LCD
clearance - Variable in class lejos.robotics.mapping.PCNavigationModel
 
clearanceField - Variable in class lejos.robotics.mapping.NavigationPanel
 
clearanceLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
clearDisplay() - Static method in class lejos.nxt.LCD
 
clearField - Variable in class lejos.robotics.mapping.NavigationPanel
 
clearLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
clearPath() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a CLEAR_PATH event to the NXT
clearPath() - Method in class lejos.robotics.navigation.Navigator
Clears the current path.
CLIToolProgressMonitor - Class in lejos.pc.tools
Simple implementation of ToolProgressMonitor with output to System.out.
CLIToolProgressMonitor() - Constructor for class lejos.pc.tools.CLIToolProgressMonitor
 
Clock - Interface in lejos.robotics
Interface for real time clock devices
clone() - Method in class lejos.geom.Point
returns a clone of itself
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
Deprecated. call disconnect, then close the underlying NXTComm
close() - Method in interface lejos.nxt.remote.NXTCommRequest
Close the connection
CLOSE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
close() - Static method in class lejos.pc.comm.NXTCommandConnector
 
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.NXTCommOutputStream
 
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.
close() - Method in class lejos.pc.tools.ConsoleViewComms
Close the connection
close() - Method in class lejos.pc.tools.DataViewComms
 
closeAll() - Method in class lejos.pc.comm.NXTConnectionManager
 
closeConnection() - Method in class lejos.pc.charting.LoggerComms
Flush the streams, close the connection and clean up.
closeFile(byte) - Method in class lejos.nxt.remote.NXTCommand
Closes an open file.
closest - Variable in class lejos.robotics.mapping.PCNavigationModel
 
CLOSEST_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
CLOSEST_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
closestColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
cname() - Method in class js.tinyvm.TinyVMType
 
CODE_UPDATE_PROP - Static variable in class lejos.pc.tools.NXJImageCodePanel
 
CodeSequence - Class in js.tinyvm
 
CodeSequence() - Constructor for class js.tinyvm.CodeSequence
 
CodeUtilities - Class in js.tinyvm
 
CodeUtilities(String, JavaClass, Binary) - Constructor for class js.tinyvm.CodeUtilities
 
COL_DELETE - Static variable in class lejos.pc.tools.ExtendedFileModel
 
COL_NAME - Static variable in class lejos.pc.tools.ExtendedFileModel
 
COL_SIZE - Static variable in class lejos.pc.tools.ExtendedFileModel
 
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
 
colorChooser - Variable in class lejos.robotics.mapping.NavigationPanel
 
ColorDetector - Interface in lejos.robotics
This interface defines the methods of a generic ColorDetector object.
ColorHTSensor - Class in lejos.nxt.addon
HiTechnic color sensor.
www.hitechnic.com This class does support HiTechnic Color Sensor V2.
ColorHTSensor(I2CPort) - Constructor for class lejos.nxt.addon.ColorHTSensor
 
colorKeys - Variable in class lejos.robotics.mapping.MapPanel
 
colorMap - Static variable in class lejos.nxt.ColorSensor
 
colorMenu - Variable in class lejos.robotics.mapping.NavigationPanel
 
colors - Variable in class lejos.robotics.mapping.MapPanel
 
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
 
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
 
commandPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
commandsMenu - Variable in class lejos.robotics.mapping.NavigationPanel
 
COMMUNICATION_BUS_ERROR - Static variable in class lejos.nxt.remote.ErrorMessages
 
compass - Variable in class lejos.robotics.navigation.CompassPilot
Deprecated.  
CompassHTSensor - Class in lejos.nxt.addon
This class supports the HiTechnic compass sensor.
CompassHTSensor(I2CPort, int) - Constructor for class lejos.nxt.addon.CompassHTSensor
Create a compass sensor object
CompassHTSensor(I2CPort) - Constructor for class lejos.nxt.addon.CompassHTSensor
Create a compass sensor object
CompassMindSensor - Class in lejos.nxt.addon
This class supports the Mindsensors compass sensor.
CompassMindSensor(I2CPort, int) - Constructor for class lejos.nxt.addon.CompassMindSensor
Create a compass sensor object
CompassMindSensor(I2CPort) - Constructor for class lejos.nxt.addon.CompassMindSensor
Create a compass sensor object
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.
computeClassSize() - Method in class js.tinyvm.ClassRecord
 
configurate() - Method in class lejos.nxt.addon.SensorMux
This method is necessary to execute to connect sensors on it
configureDetector - Variable in class lejos.robotics.mapping.NavigationPanel
 
configureMCL - Variable in class lejos.robotics.mapping.NavigationPanel
 
configureMenu - Variable in class lejos.robotics.mapping.NavigationPanel
 
configureMesh - Variable in class lejos.robotics.mapping.NavigationPanel
 
configurePilot - Variable in class lejos.robotics.mapping.NavigationPanel
 
configureRandom - Variable in class lejos.robotics.mapping.NavigationPanel
 
configureScanner - Variable in class lejos.robotics.mapping.NavigationPanel
 
connect(String) - Method in class lejos.pc.charting.LoggerComms
Connect to a listening NXT.
connect - Variable in class lejos.robotics.mapping.NavigationPanel
 
connect(String) - Method in class lejos.robotics.mapping.PCNavigationModel
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.
connectAndUpload(String, File) - Method in class lejos.robotics.mapping.PCNavigationModel
Connect to the NXT, upload a program, and run it
connectButton - Variable in class lejos.robotics.mapping.NavigationPanel
 
connected - Variable in class lejos.robotics.mapping.PCNavigationModel
 
connectedLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
connectedTo(String, String) - Method in class lejos.pc.tools.ConsoleViewerSwingUI
 
connectedTo(String, String) - Method in interface lejos.pc.tools.ConsoleViewerUI
 
connectedTo(String, String) - Method in interface lejos.pc.tools.DataViewerUI
 
connectedTo(String, String) - Method in class lejos.pc.tools.NXJConsole
 
connectedTo(String, String) - Method in class lejos.pc.tools.NXJConsoleViewer
 
connectedTo(String, String) - Method in class lejos.pc.tools.NXJControl
Used by console viewer
connectedTo(String, String) - Method in class lejos.pc.tools.NXJDataViewer
Set the name and address of the NXT connected to
connectionState - Variable in class lejos.pc.comm.NXTInfo
the present connection state of the NXT
connecTo(String, String, boolean) - Method in class lejos.pc.tools.DataViewComms
 
connectPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
connectTo() - Method in class lejos.pc.comm.NXTConnector
Connect to any NXT over any protocol in NXTComm.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 instance
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 NXTComm.PACKET mode
connectTo(String, String, boolean, boolean) - Method in class lejos.pc.tools.ConsoleViewComms
Connect to RConsole on the NXT uusing either USB or Bluetooth
connectTo(String, String, int, boolean) - Method in class lejos.pc.tools.ConsoleViewComms
Connect to RConsole on the NXT using the specified protocols
connectTo(String, String, int) - Method in class lejos.pc.tools.DataViewComms
 
connectToBrick(NXTInfo) - Method in class lejos.pc.comm.NXTConnectionManager
connects to a NXT brick
Console - Class in lejos.pc.tools
Deprecated. use lejos.pc.tools.NXJConsole instead
Console() - Constructor for class lejos.pc.tools.Console
Deprecated.  
ConsoleDebug - Interface in lejos.pc.tools
 
ConsoleDebugDisplay - Class in lejos.pc.tools
 
ConsoleDebugDisplay(ConsoleViewerUI) - Constructor for class lejos.pc.tools.ConsoleDebugDisplay
 
ConsoleDebugDisplay(ConsoleViewerUI, String) - Constructor for class lejos.pc.tools.ConsoleDebugDisplay
 
ConsoleDebugDisplay(ConsoleViewerUI, DebugData) - Constructor for class lejos.pc.tools.ConsoleDebugDisplay
 
ConsoleViewComms - Class in lejos.pc.tools
Contains the logic for connecting to RConsole on the NXT and downloading data.
ConsoleViewComms(ConsoleViewerUI, ConsoleDebug, boolean) - Constructor for class lejos.pc.tools.ConsoleViewComms
 
ConsoleViewer - Class in lejos.pc.tools
Deprecated. use lejos.pc.tools.NXJLink instead
ConsoleViewer() - Constructor for class lejos.pc.tools.ConsoleViewer
Deprecated.  
ConsoleViewerSwingUI - Class in lejos.pc.tools
 
ConsoleViewerSwingUI(ConsoleViewerUI) - Constructor for class lejos.pc.tools.ConsoleViewerSwingUI
 
ConsoleViewerUI - Interface in lejos.pc.tools
 
ConstantRecord - Class in js.tinyvm
 
ConstantRecord(ConstantPool, Constant, Binary) - Constructor for class js.tinyvm.ConstantRecord
Constructor.
ConstantRecord(ClassRecord, Binary) - Constructor for class js.tinyvm.ConstantRecord
 
constantValue() - Method in class js.tinyvm.ConstantRecord
Get dereferenced value.
ConstantValue - Class in js.tinyvm
This class represents a constant value of a basic type.
ConstantValue(ConstantPool, Constant, Binary) - Constructor for class js.tinyvm.ConstantValue
Constructor.
ConstantValue(ClassRecord, Binary) - Constructor for class js.tinyvm.ConstantValue
 
constructWithCopy(double[][]) - Static method in class lejos.util.Matrix
Construct a matrix from a copy of a 2-D array.
containsKey(Object) - Method in class js.tinyvm.util.HashVector
 
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
 
controlPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.
convertImage() - Method in class lejos.pc.tools.NXJImagePicturePanel
 
convertTo(float, DIMUAccel.AccelUnits) - Method in enum lejos.nxt.addon.DIMUAccel.AccelUnits
Converts a value to specified unit
convertTo(float[], DIMUAccel.AccelUnits) - Method in enum lejos.nxt.addon.DIMUAccel.AccelUnits
Converts an array of values in place to specified unit
convertTo(float, DIMUAccel.TiltUnits) - Method in enum lejos.nxt.addon.DIMUAccel.TiltUnits
Converts a value to specified unit
convertTo(float[], DIMUAccel.TiltUnits) - Method in enum lejos.nxt.addon.DIMUAccel.TiltUnits
Converts an array of values in place to specified unit
convertTo(float, DIMUGyro.RateUnits) - Method in enum lejos.nxt.addon.DIMUGyro.RateUnits
Converts a value to specified unit
convertTo(float[], DIMUGyro.RateUnits) - Method in enum lejos.nxt.addon.DIMUGyro.RateUnits
Converts an array of values in place to specified unit
convertTo(float, DIMUGyro.TemperatureUnits) - Method in enum lejos.nxt.addon.DIMUGyro.TemperatureUnits
Converts a value to specified unit
copy() - Method in class lejos.util.Matrix
Make a deep copy of a matrix
copyChart() - Method in class lejos.pc.charting.CustomChartPanel
 
copyCode(RecordTable<CodeSequence>, JavaClass, Binary) - Method in class js.tinyvm.MethodRecord
 
copyCode(byte[], JavaClass, Binary) - Method in class js.tinyvm.MethodRecord
 
copyTo(Point) - Method in class lejos.geom.Point
 
count - Variable in class lejos.nxt.addon.RCXRotationSensor
 
cpEntryId(Constant) - Static method in class js.tinyvm.ClassRecord
 
createAboutMenu() - Method in class lejos.robotics.mapping.NavigationPanel
Create an About menu
createAccelerometer(I2CPort) - Static method in class lejos.nxt.addon.SensorSelector
 
createCommandMenu() - Method in class lejos.robotics.mapping.NavigationPanel
Create the Commands menu
createCommandPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the command panel - this is added to by overriding classes
createConfigureMenu() - Method in class lejos.robotics.mapping.NavigationPanel
Create the Configure menu
createConnectPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the Connect panel to allow connection to a NXT brick
createControlPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the control panel, which controls the GUI
createDetectorPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the Feature Detector configuration form
createDifferentialPanel() - Method in class lejos.robotics.mapping.NavigationPanel
 
createFileMenu() - Method in class lejos.robotics.mapping.NavigationPanel
Create a File menu
createFilesystemImage() - Method in class lejos.pc.tools.NXJFlashUpdate
Create a memory image for the leJOS file system.
createFinderPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the PathFinder configuration form
createFirmwareImage(File, File, String) - Method in class lejos.pc.tools.NXJFlashUpdate
Create the memory image ready to be flashed to the device.
createFromClosureOf(String[], ClassPath, boolean) - Static method in class js.tinyvm.Binary
Create closure.
createHelpMenu() - Method in class lejos.robotics.mapping.NavigationPanel
Create a help menu
createInputStream(int, int) - Method in class lejos.pc.comm.NXTSamba
 
createIRTransmitter(I2CPort) - Static method in class lejos.nxt.addon.SensorSelector
 
createLoadPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create load map panel
createMapMenu() - Method in class lejos.robotics.mapping.NavigationPanel
Create a Map menu
createMapPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the map panel
createMCLPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the MCL configuration form
createMenu() - Method in class lejos.robotics.mapping.NavigationPanel
Create the menu
createMeshPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the mesh configuration panel
createMovePanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the move panel, which shows the last move made by the robot
createNXTComm(int) - Static method in class lejos.pc.comm.NXTCommFactory
Load a comms driver for a protocol (USB or Bluetooth)
createParticlePanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the particle panel which shows range readings for a specific particle
createPilotPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the Pilot Configuration Form
createRandomPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the Random Move configuration form
createReadingsPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the readings panel which shows the last range readings
createScannerPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the range scanner configuration form
createStatusPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the status Panel
createSteeringPanel() - Method in class lejos.robotics.mapping.NavigationPanel
 
createSVGFile(String) - Method in class lejos.robotics.mapping.LineMap
Create an SVG map file
createViewMenu() - Method in class lejos.robotics.mapping.NavigationPanel
Create a View menu
createXYPanel() - Method in class lejos.robotics.mapping.NavigationPanel
Create the map panel which shows the mouse position in map coordinates
CruizcoreGyro - Class in lejos.nxt.addon
This Class manages the Micro Infinity Cruizcore XG1300L
CruizcoreGyro(I2CPort) - Constructor for class lejos.nxt.addon.CruizcoreGyro
Instantiates a new Cruizcore Gyro sensor.
currentPose - Variable in class lejos.robotics.mapping.NavigationModel
 
CUSTOM - Static variable in class lejos.nxt.addon.OpticalDistanceSensor
Custom sensor
CUSTOM - Static variable in interface lejos.nxt.remote.NXTProtocol
 
CustomChartPanel - Class in lejos.pc.charting
JPanel acting as a container for the LoggingChart ChartPanel, domain slider, x-y label, and rowcount label.
CustomChartPanel() - Constructor for class lejos.pc.charting.CustomChartPanel
 
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 class lejos.nxt.remote.ErrorMessages
 
DATA_FLAVOR - Static variable in class lejos.pc.tools.FileDrop.TransferableObject
The default DataFlavor for FileDrop.TransferableObject has the representation class net.iharder.dnd.TransferableObject.class and the MIME type application/x-net.iharder.dnd.TransferableObject.
dataInputStreamEOF() - Method in interface lejos.pc.charting.LoggerListener
Invoked when an EOFException (or other IOException) occurs from the LoggerComms instance.
DataItem - Class in lejos.pc.charting
Each logged data item is represented by a DataItem instance which provide the value as a wrapper and it's datatype.
DataItem() - Constructor for class lejos.pc.charting.DataItem
 
DataLogger - Class in lejos.pc.charting
This class provides the PC side of the lejos.util.NXTDataLogger counterpart running on the NXT.
DataLogger(LoggerProtocolManager, File, boolean) - Constructor for class lejos.pc.charting.DataLogger
Create a DataLogger instance.
datatype - Variable in class lejos.pc.charting.DataItem
The datatype.
DataViewComms - Class in lejos.pc.tools
 
DataViewComms(DataViewerUI) - Constructor for class lejos.pc.tools.DataViewComms
 
DataViewer - Class in lejos.pc.tools
Deprecated. use lejos.pc.tools.NXJLink instead
DataViewer() - Constructor for class lejos.pc.tools.DataViewer
Deprecated.  
DataViewerUI - Interface in lejos.pc.tools
 
DCMotor - Interface in lejos.robotics
Interface for a regular DC motor.
debug - Variable in class lejos.robotics.mapping.NavigationModel
 
DebugData - Class in js.tinyvm
 
DebugData() - Constructor for class js.tinyvm.DebugData
 
DebugMessages - Class in lejos.util
This class has been developed to use it in case of you have to tests leJOS programs and you need to show in NXT Display data but you don't need to design a User Interface.
DebugMessages() - Constructor for class lejos.util.DebugMessages
 
DebugMessages(int) - Constructor for class lejos.util.DebugMessages
Constructor which the user establish in what line start showing messages
DebugOptions - Enum in js.tinyvm
 
decode(byte[]) - Static method in class lejos.nxt.remote.AsciizCodec
Convert an ASCIIZ byte array to a string
decodeIntBE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeIntLE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeLongBE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeLongLE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeShortBE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeShortLE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeUIntBE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeUIntLE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeUShortBE(byte[], int) - Static method in class lejos.util.EndianTools
 
decodeUShortLE(byte[], int) - Static method in class lejos.util.EndianTools
 
DEFAULT_I2C_ADDRESS - Static variable in class lejos.nxt.addon.DIMUAccel
 
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
 
defaultColors - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
 
delayField - Variable in class lejos.robotics.mapping.NavigationPanel
 
delayLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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(String, int) - Method in class lejos.pc.tools.ExtendedFileModel
Delete a file on the NXT and update the model
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.
description - Variable in class lejos.robotics.mapping.NavigationPanel
 
destination - Variable in class lejos.robotics.mapping.PCNavigationModel
 
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
detector - Variable in class lejos.robotics.mapping.NavigationPanel
 
detectorForm - Variable in class lejos.robotics.mapping.NavigationPanel
 
detectorOKButton - Variable in class lejos.robotics.mapping.NavigationPanel
 
detectorPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
 
differentialPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
 
DIMUAccel - Class in lejos.nxt.addon
This class provides access to the accelerometer of Dexter Industries IMU sensor
DIMUAccel(I2CPort) - Constructor for class lejos.nxt.addon.DIMUAccel
 
DIMUAccel.AccelUnits - Enum in lejos.nxt.addon
List of possible units for acceleration
DIMUAccel.TiltUnits - Enum in lejos.nxt.addon
List of possible units for Tilt
DIMUGyro - Class in lejos.nxt.addon
This class provides access to the gyro of Dexter Industries IMU sensor.
DIMUGyro(I2CPort) - Constructor for class lejos.nxt.addon.DIMUGyro
 
DIMUGyro.Axis - Enum in lejos.nxt.addon
Axis units supported by the sensor.
DIMUGyro.Range - Enum in lejos.nxt.addon
Dynamic ranges supported by the sensor
DIMUGyro.RateUnits - Enum in lejos.nxt.addon
Rotation units supported by the sensor
DIMUGyro.SampleRate - Enum in lejos.nxt.addon
Internal sample rates supported by the sensor
DIMUGyro.TemperatureUnits - Enum in lejos.nxt.addon
Temperature units supported by the sensor
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.
DIRECTORY_FULL - Static variable in class lejos.nxt.remote.ErrorMessages
 
dis - Variable in class lejos.robotics.mapping.NavigationModel
 
disconnect() - Method in class lejos.nxt.remote.NXTCommand
Tell the NXT that the connection is aborted.
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.
display(int, int) - Method in class lejos.util.TextMenu
helper method used by select()
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.robotics.mapping.NavigationModel
 
dotProduct(Point) - Method in class lejos.geom.Point
Returns the inner dot product.
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.
DPressure250 - Class in lejos.nxt.addon
Support for Dexter Industries DPressure250 Not tested.
DPressure250(ADSensorPort) - Constructor for class lejos.nxt.addon.DPressure250
 
DPressure500 - Class in lejos.nxt.addon
Support for Dexter Industries DPressure500 Not tested.
DPressure500(ADSensorPort) - Constructor for class lejos.nxt.addon.DPressure500
 
drawChar(char, int, int) - Static method in class lejos.nxt.LCD
 
drawInt(int, int, int) - Static method in class lejos.nxt.LCD
 
drawInt(int, int, int, int) - Static method in class lejos.nxt.LCD
 
drawInvertedChar(char, int, int) - Static method in class lejos.nxt.LCD
 
drawString(String, int, int) - Static method in class lejos.nxt.LCD
 
drawString(String, int, int, boolean) - Static method in class lejos.nxt.LCD
 
driveMotorBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
driveMotorLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
driveReverseBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
driveReverseLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
DT_BOOLEAN - Static variable in class lejos.pc.charting.DataItem
 
DT_BYTE - Static variable in class lejos.pc.charting.DataItem
 
DT_DOUBLE - Static variable in class lejos.pc.charting.DataItem
 
DT_FLOAT - Static variable in class lejos.pc.charting.DataItem
 
DT_INTEGER - Static variable in class lejos.pc.charting.DataItem
 
DT_LONG - Static variable in class lejos.pc.charting.DataItem
 
DT_SHORT - Static variable in class lejos.pc.charting.DataItem
 
DT_STRING - Static variable in class lejos.pc.charting.DataItem
 
dump(IByteWriter) - Method in class js.tinyvm.Binary
Dump.
dump(IByteWriter) - Method in class js.tinyvm.ClassRecord
 
dump(IByteWriter) - Method in class js.tinyvm.CodeSequence
 
dump(IByteWriter) - Method in class js.tinyvm.ConstantRecord
Dump.
dump(IByteWriter) - Method in class js.tinyvm.ConstantValue
Dump.
dump(IByteWriter) - Method in class js.tinyvm.EntryClassIndex
 
dump(IByteWriter) - Method in class js.tinyvm.ExceptionRecord
 
dump(IByteWriter) - Method in class js.tinyvm.InstanceFieldRecord
 
dump(IByteWriter) - Method in class js.tinyvm.InterfaceMap
Write the map to the executable file.
dump(IByteWriter) - Method in class js.tinyvm.MasterRecord
Dump.
dump(IByteWriter) - Method in class js.tinyvm.MethodRecord
 
dump(IByteWriter) - Method in class js.tinyvm.RecordTable
Dump all elements.
dump(IByteWriter) - Method in class js.tinyvm.StaticFieldRecord
 
dump(IByteWriter) - Method in class js.tinyvm.StaticValue
 
dump(Binary, OutputStream, boolean, OutputStream) - Method in class js.tinyvm.TinyVMTool
Dump binary to stream.
dump(IByteWriter) - Method in interface js.tinyvm.WritableData
Dump.
dumpClosest(RangeReadings, 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.
dumpDebug(OutputStream) - Method in class js.tinyvm.Binary
Dump debug data.
dumpObject(DataOutputStream) - Method in class lejos.robotics.localization.MCLParticleSet
Serialize the particle set to a data output stream
dumpObject(DataOutputStream) - Method in class lejos.robotics.localization.MCLPoseProvider
Dump the serialized estimate of pose to a data output stream
dumpObject(DataOutputStream) - Method in class lejos.robotics.mapping.LineMap
Dump the map to a DataOutputStream
dumpObject(DataOutputStream) - Method in class lejos.robotics.navigation.Move
 
dumpObject(DataOutputStream) - Method in class lejos.robotics.navigation.Pose
 
dumpObject(DataOutputStream) - Method in class lejos.robotics.navigation.Waypoint
 
dumpObject(DataOutputStream) - Method in class lejos.robotics.objectdetection.RangeFeature
 
dumpObject(DataOutputStream) - Method in class lejos.robotics.pathfinding.Path
 
dumpObject(DataOutputStream) - Method in class lejos.robotics.RangeReadings
Dump the readings to a DataOutputStream
dumpObject(DataOutputStream) - Method in interface lejos.robotics.Transmittable
 
dynamicOffset - Variable in class lejos.nxt.addon.DIMUGyro
 

E

echo(String) - Method in class lejos.util.DebugMessages
Show in NXT Screen a message
echo(int) - Method in class lejos.util.DebugMessages
Show in NXT Screen a message
EEPROM_BUFFER - Static variable in class lejos.nxt.addon.RCXLink
 
elapsed() - Method in class lejos.util.Stopwatch
Return elapsed time in milliseconds
elementAt(int) - Method in class js.tinyvm.util.HashVector
 
elements() - Method in class js.tinyvm.util.HashVector
 
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.
enableThresholdControls(boolean) - Method in class lejos.pc.tools.NXJImagePicturePanel
 
enableTracking(boolean) - Method in class lejos.nxt.addon.NXTCam
 
encode(String) - Static method in class lejos.nxt.remote.AsciizCodec
Encode a string as ASCIIZ
encodeIntBE(int, byte[], int) - Static method in class lejos.util.EndianTools
 
encodeIntLE(int, byte[], int) - Static method in class lejos.util.EndianTools
 
encodeLongBE(long, byte[], int) - Static method in class lejos.util.EndianTools
 
encodeLongLE(long, byte[], int) - Static method in class lejos.util.EndianTools
 
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.
encoderPort - Variable in class lejos.nxt.NXTMotor
 
encodeShortBE(int, byte[], int) - Static method in class lejos.util.EndianTools
 
encodeShortLE(int, byte[], int) - Static method in class lejos.util.EndianTools
 
END_OF_FILE - Static variable in class lejos.nxt.remote.ErrorMessages
 
END_OF_FILE_EXPECTED - Static variable in class lejos.nxt.remote.ErrorMessages
 
EndianTools - Class in lejos.util
Tools for manipulating numbers in little-endian and big-endian encodings
EndianTools() - Constructor for class lejos.util.EndianTools
 
ENTER - Static variable in class lejos.nxt.Button
The Enter button.
EntryClassIndex - Class in js.tinyvm
 
EntryClassIndex(Binary, String) - Constructor for class js.tinyvm.EntryClassIndex
 
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
 
equals(Object) - Method in class js.tinyvm.ClassRecord
 
equals(Object) - Method in class js.tinyvm.ConstantRecord
Equals based on equality of referenced value.
equals(Object) - Method in class js.tinyvm.ExceptionRecord
 
equals(Object) - Method in class js.tinyvm.InstanceFieldRecord
 
equals(Object) - Method in class js.tinyvm.MethodRecord
 
equals(Object) - Method in class js.tinyvm.Signature
 
equals(Object) - Method in class js.tinyvm.StaticFieldRecord
 
equals(Object) - Method in class js.tinyvm.StaticValue
 
equals(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
err - Static variable in class lejos.pc.comm.SystemContext
Deprecated.  
ERROR - Static variable in class lejos.nxt.addon.AccelHTSensor
 
ERROR - Static variable in class lejos.nxt.addon.AccelMindSensor
 
error(String) - Method in interface lejos.robotics.mapping.MapApplicationUI
Display an error message
error(String) - Method in class lejos.robotics.mapping.NavigationPanel
Show a pop-up error message
ErrorMessages - Class in lejos.nxt.remote
Error messages that can be returned after a call to the NXT brick.
ESCAPE - Static variable in class lejos.nxt.Button
The Escape button.
ESTIMATE_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
ESTIMATE_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
estimateColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
estimatePose() - Method in class lejos.robotics.localization.MCLPoseProvider
Estimate pose from weighted average of the particles Calculate statistics
event - Variable in class lejos.robotics.mapping.SliderPanel
 
eventCombo - Variable in class lejos.robotics.mapping.EventPanel
 
eventLabel - Variable in class lejos.robotics.mapping.EventPanel
 
EventPanel - Class in lejos.robotics.mapping
A panel to send navigation events to a PC running NXTNavigationModel.
EventPanel(PCNavigationModel, NavigationPanel, NavigationModel.NavEvent[]) - Constructor for class lejos.robotics.mapping.EventPanel
 
eventPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
eventReceived(NavigationModel.NavEvent) - Method in class lejos.pc.tools.NXJMapCommand
Set the sliders when the pose is changed
eventReceived(NavigationModel.NavEvent) - Method in interface lejos.robotics.mapping.MapApplicationUI
Signal that an event has been received (normally from the NXT).
eventReceived(NavigationModel.NavEvent) - Method in interface lejos.robotics.mapping.NavEventListener
 
eventReceived(NavigationModel.NavEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Override this method to perform some action (other than repaining) when an event is received
events - Variable in class lejos.robotics.mapping.EventPanel
 
exception(int, String, int[]) - Method in interface lejos.pc.tools.ConsoleDebug
 
exception(int, String, int[]) - Method in class lejos.pc.tools.ConsoleDebugDisplay
 
ExceptionRecord - Class in js.tinyvm
 
ExceptionRecord(CodeException, Binary, JavaClass) - Constructor for class js.tinyvm.ExceptionRecord
 
exit(int) - Static method in class lejos.nxt.NXT
Close the connection to the NXT and exit
exit - Variable in class lejos.robotics.mapping.NavigationPanel
 
exitOnBadOpCode(int) - Method in class js.tinyvm.CodeUtilities
 
ExtendedFileModel - Class in lejos.pc.tools
Swing Table Model for manipulating NXT files.
ExtendedFileModel() - Constructor for class lejos.pc.tools.ExtendedFileModel
Fetch files from the NXT and create the model

F

F_OFFSET_MASK - Static variable in class js.tinyvm.TinyVMConstants
 
F_SIZE_SHIFT - Static variable in class js.tinyvm.TinyVMConstants
 
FAHRENHEITMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
fatal(String) - Method in interface lejos.robotics.mapping.MapApplicationUI
Fatal error which stops the application
fatal(String) - Method in class lejos.robotics.mapping.NavigationPanel
Print the error message and exit
feature - Variable in class lejos.robotics.mapping.NavigationModel
 
Feature - Interface in lejos.robotics.objectdetection
A Feature is an interface for information retrieved about an object detected by sensors.
FEATURE_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
FEATURE_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
featureColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.
features - Variable in class lejos.robotics.mapping.PCNavigationModel
 
fetchAllAccel(float[]) - Method in class lejos.nxt.addon.DIMUAccel
Acceleration along 3 axis.
fetchAllAccel(float[], DIMUAccel.AccelUnits) - Method in class lejos.nxt.addon.DIMUAccel
Acceleration along 3 axis.
fetchAllRate(float[]) - Method in class lejos.nxt.addon.DIMUGyro
 
fetchAllRate(float[], DIMUGyro.RateUnits) - Method in class lejos.nxt.addon.DIMUGyro
 
fetchAllTilt(float[]) - Method in class lejos.nxt.addon.DIMUAccel
Tilt along 3 axis
fetchAllTilt(float[], DIMUAccel.TiltUnits) - Method in class lejos.nxt.addon.DIMUAccel
Tilt along 3 axis.
fetchFiles(NXTCommand) - Method in class lejos.pc.tools.ExtendedFileModel
Fetch the files from the NXT
fetchRawAccel(int[]) - Method in class lejos.nxt.addon.DIMUAccel
 
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.
fetchTemperature() - Method in class lejos.nxt.addon.DIMUGyro
Temperature is not calibrated.
FILE_EXISTS - Static variable in class lejos.nxt.remote.ErrorMessages
 
FILE_IS_BUSY - Static variable in class lejos.nxt.remote.ErrorMessages
 
FILE_IS_FULL - Static variable in class lejos.nxt.remote.ErrorMessages
 
FILE_NOT_FOUND - Static variable in class lejos.nxt.remote.ErrorMessages
 
FileDrop - Class in lejos.pc.tools
This class makes it easy to drag and drop files from the operating system to a Java program.
FileDrop(Component, FileDrop.Listener) - Constructor for class lejos.pc.tools.FileDrop
Constructs a FileDrop with a default light-blue border and, if c is a Container, recursively sets all elements contained within as drop targets, though only the top level container will change borders.
FileDrop(Component, boolean, FileDrop.Listener) - Constructor for class lejos.pc.tools.FileDrop
Constructor with a default border and the option to recursively set drop targets.
FileDrop(PrintStream, Component, FileDrop.Listener) - Constructor for class lejos.pc.tools.FileDrop
Constructor with a default border and debugging optionally turned on.
FileDrop(PrintStream, Component, boolean, FileDrop.Listener) - Constructor for class lejos.pc.tools.FileDrop
Constructor with a default border, debugging optionally turned on and the option to recursively set drop targets.
FileDrop(Component, Border, FileDrop.Listener) - Constructor for class lejos.pc.tools.FileDrop
Constructor with a specified border
FileDrop(Component, Border, boolean, FileDrop.Listener) - Constructor for class lejos.pc.tools.FileDrop
Constructor with a specified border and the option to recursively set drop targets.
FileDrop(PrintStream, Component, Border, FileDrop.Listener) - Constructor for class lejos.pc.tools.FileDrop
Constructor with a specified border and debugging optionally turned on.
FileDrop(PrintStream, Component, Border, boolean, FileDrop.Listener) - Constructor for class lejos.pc.tools.FileDrop
Full constructor with a specified border and debugging optionally turned on.
FileDrop.Event - Class in lejos.pc.tools
This is the event that is passed to the filesDropped(...) method in your FileDropListener when files are dropped onto a registered drop target.
FileDrop.Event(File[], Object) - Constructor for class lejos.pc.tools.FileDrop.Event
Constructs an FileDrop.Event with the array of files that were dropped and the FileDrop that initiated the event.
FileDrop.Listener - Interface in lejos.pc.tools
Implement this inner interface to listen for when files are dropped.
FileDrop.TransferableObject - Class in lejos.pc.tools
At last an easy way to encapsulate your custom objects for dragging and dropping in your Java programs! When you need to create a Transferable object, use this class to wrap your object.
FileDrop.TransferableObject(Object) - Constructor for class lejos.pc.tools.FileDrop.TransferableObject
Creates a new FileDrop.TransferableObject that wraps data.
FileDrop.TransferableObject(FileDrop.TransferableObject.Fetcher) - Constructor for class lejos.pc.tools.FileDrop.TransferableObject
Creates a new FileDrop.TransferableObject that will return the object that is returned by fetcher.
FileDrop.TransferableObject(Class, FileDrop.TransferableObject.Fetcher) - Constructor for class lejos.pc.tools.FileDrop.TransferableObject
Creates a new FileDrop.TransferableObject that will return the object that is returned by fetcher.
FileDrop.TransferableObject.Fetcher - Interface in lejos.pc.tools
Instead of passing your data directly to the FileDrop.TransferableObject constructor, you may want to know exactly when your data was received in case you need to remove it from its source (or do anyting else to it).
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
 
fileMenu - Variable in class lejos.robotics.mapping.NavigationPanel
 
fileName - Variable in class lejos.nxt.remote.FileInfo
The name of the file - up to 20 characters.
filesDropped(File[]) - Method in interface lejos.pc.tools.FileDrop.Listener
This method is called when files have been successfully dropped.
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
finalize() - Method in class lejos.pc.comm.NXTCommUSB
 
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.
findClosest(float, float) - Method in class lejos.robotics.mapping.PCNavigationModel
Send a FIND_CLOSEST event to the NXT
finder - Variable in class lejos.robotics.mapping.NavigationPanel
 
finderForm - Variable in class lejos.robotics.mapping.NavigationPanel
 
finderOKButton - Variable in class lejos.robotics.mapping.NavigationPanel
 
finderPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
findFirst(String) - Method in class lejos.nxt.remote.NXTCommand
Find the first file on the NXT.
findHiddenMethods() - Method in class js.tinyvm.ClassRecord
 
findNext(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(Waypoint) - Method in class lejos.robotics.mapping.PCNavigationModel
Send a FIND_PATH event to the NXT
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 ( 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
 
firmwareMajorVersion - Variable in class lejos.nxt.remote.NXJFirmwareInfo
 
firmwareMinorVersion - Variable in class lejos.nxt.remote.NXJFirmwareInfo
 
firmwarePatchLevel - Variable in class lejos.nxt.remote.NXJFirmwareInfo
 
firmwareRevision - Variable in class lejos.nxt.remote.NXJFirmwareInfo
 
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
 
flip() - Method in class lejos.robotics.mapping.LineMap
Create a line map with the y axis flipped
FLOAT - Static variable in interface lejos.nxt.BasicMotorPort
Motor is floating (no PWM drive)
fLogListeners - Variable in class lejos.pc.comm.NXTCommLoggable
 
flt() - Method in class lejos.nxt.addon.MMXMotor
Causes motor to float.
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.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 class lejos.robotics.MirrorMotor
 
flt() - Method in class lejos.robotics.MirrorMotor
 
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
 
followPath - Variable in class lejos.robotics.mapping.NavigationPanel
 
followPath() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a route to the NXT and follow it
followPath(Path) - Method in class lejos.robotics.navigation.Navigator
Starts the robot traversing the path.
followPath() - Method in class lejos.robotics.navigation.Navigator
Starts the robot traversing the current path.
FONT_HEIGHT - Static variable in class lejos.nxt.LCD
 
FONT_WIDTH - Static variable in class lejos.nxt.LCD
 
forward() - Method in class lejos.nxt.addon.LServo
Classic forward method for continous RC Servos
forward() - Method in class lejos.nxt.addon.MMXMotor
Causes motor to rotate forward.
forward() - Method in class lejos.nxt.addon.MMXRegulatedMotor
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.MirrorMotor
 
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.OmniPilot
 
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.
frame - Variable in class lejos.robotics.mapping.NavigationPanel
 
freeFlash - Variable in class lejos.nxt.remote.DeviceInfo
 
fullMethod(JavaClass, String) - Static method in class js.tinyvm.CodeUtilities
 
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

Gauge - Class in lejos.pc.tools
Swing Gauge Component for displaying the value of a NXT sensor.
Gauge() - Constructor for class lejos.pc.tools.Gauge
Create the gauge
gearRatio - Variable in class lejos.robotics.RotatingRangeScanner
 
gearRatioField - Variable in class lejos.robotics.mapping.NavigationPanel
 
gearRatioLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
genConstantLoad(int) - Method in class js.tinyvm.CodeUtilities
Process a constant load operation.
generateParticles() - Method in class lejos.robotics.localization.MCLPoseProvider
Generate a new particle set, uniformly distributed within the map, and uniformly distributed heading.
generateParticles() - Method in class lejos.robotics.mapping.PCNavigationModel
Generate particles for the MCLPoseProvider and send them to the NXT
genStaticAccess(int, int, int) - Method in class js.tinyvm.CodeUtilities
Generate and instruction to access a static field.
get(int) - Method in class js.tinyvm.RecordTable
Get writable element by its index.
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.
getAccelUnit() - Method in class lejos.nxt.addon.DIMUAccel
Returns the current acceleration unit
getAccumulatedAngle() - Method in class lejos.nxt.addon.AngleSensor
 
getActualMode() - Method in class lejos.nxt.UltrasonicSensor
Returns the current operating mode of the sensor.
getAddress() - Method in class lejos.nxt.I2CSensor
Return the the I2C address of the sensor.
getAddress() - Method in class lejos.pc.tools.NXJLinkAndUploadCommandLineParser
 
getAlignment() - Method in class js.tinyvm.ConstantValue
Returns the ideal data alignment for this data type.
getAlignment() - Method in class js.tinyvm.StaticValue
 
getAllAccel(int[], int) - Method in class lejos.nxt.addon.AccelHTSensor
Reads all 3 acceleration values into the given array.
getAllAccel(int[], int) - Method in class lejos.nxt.addon.AccelMindSensor
Reads all 3 acceleration values into the given array.
getAllocationSize() - Method in class js.tinyvm.ClassRecord
 
getAllocationSize() - Method in class js.tinyvm.PrimitiveClassRecord
 
getAllTilt(int[], int) - Method in class lejos.nxt.addon.AccelMindSensor
Reads all 3 tilt values into the given array.
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
getAngle() - Method in interface lejos.robotics.Servo
Gets the rotational position (angle) of a ranged servo.
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
 
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.CruizcoreGyro
 
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.
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.
getArrayClassName(String) - Static method in class js.tinyvm.ClassRecord
 
getArrayClassRecord(String, Binary, int, ClassRecord) - Static method in class js.tinyvm.PrimitiveClassRecord
 
getArrayCopy() - Method in class lejos.util.Matrix
Copy the internal two-dimensional array.
getArrayDimension() - Method in class js.tinyvm.ClassRecord
 
getArrayElementClass() - Method in class js.tinyvm.ClassRecord
 
getArrowLine(Pose) - Method in class lejos.robotics.mapping.MapPanel
Create a Line that represents the direction of the pose
getAutoRun() - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to get the auto run setring
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
getAxis(DIMUGyro.Axis) - Method in class lejos.nxt.addon.DIMUGyro
This method returns an instance of one of the three axes (X, Y, or Z) that the dIMU can supply.
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.
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.
getBlackAndWhiteImage() - Method in class lejos.pc.tools.NXJImagePicturePanel
 
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.
getButtons() - Static method in class lejos.nxt.NXTFrame
Get the button mask, which indicates which buttons have been pressed, but not consumed.
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.
getCanonicalName() - Method in class js.tinyvm.ClassRecord
 
getCanonicalName() - Method in class js.tinyvm.PrimitiveClassRecord
 
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
getClassConstant() - Method in class js.tinyvm.PrimitiveClassRecord
 
getClassFilename(int) - Method in class js.tinyvm.DebugData
 
getClassIndex(String) - Method in class js.tinyvm.Binary
Get index of class in binary by its signature.
getClassIndex(ClassRecord) - Method in class js.tinyvm.Binary
Get index of class in binary by its class record.
getClassName(int) - Method in class js.tinyvm.DebugData
 
getClassNameCount() - Method in class js.tinyvm.DebugData
 
getClassRecord(String) - Method in class js.tinyvm.Binary
Get class record with given signature.
getClassRecord(String, ClassPath, Binary) - Static method in class js.tinyvm.ClassRecord
 
getClassRecord() - Method in class js.tinyvm.MethodRecord
 
getClassRecord(String, Binary, byte) - Static method in class js.tinyvm.PrimitiveClassRecord
 
getClassRecord() - Method in class js.tinyvm.StaticFieldRecord
 
getClassRecordForArray(ClassRecord) - Method in class js.tinyvm.Binary
Return the class the represents an array of the given type and dimension.
getClassSize() - Method in class js.tinyvm.ClassRecord
 
getCode() - Method in enum lejos.nxt.addon.DIMUGyro.Range
 
getCode() - Method in enum lejos.nxt.addon.DIMUGyro.SampleRate
 
getCode() - Method in class lejos.pc.tools.NXJImageCodePanel
 
getCodeStart() - Method in class js.tinyvm.MethodRecord
 
getColor() - Method in class lejos.nxt.addon.ColorHTSensor
 
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.ColorHTSensor
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.ColorHTSensor
Essentially the same as getColorNumber() but with a resolution of 6 bits.
getColors(Properties) - Method in class lejos.robotics.mapping.MapPanel
 
getColumnClass(int) - Method in class lejos.pc.tools.ExtendedFileModel
Get the class of a specific column
getColumnClass(int) - Method in class lejos.pc.tools.NXTConnectionModel
Get the class of the object held in the column cells
getColumnCount() - Method in class lejos.pc.tools.ExtendedFileModel
Get the number of columns in the mode
getColumnCount() - Method in class lejos.pc.tools.NXTConnectionModel
Return the number of columns
getColumnDimension() - Method in class lejos.util.Matrix
Get column dimension.
getColumnName(int) - Method in class lejos.pc.tools.ExtendedFileModel
Get the name of a column
getColumnName(int) - Method in class lejos.pc.tools.NXTConnectionModel
Get the column name
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
getConnectedNXTName() - Method in class lejos.pc.charting.LoggerComms
Return the name of the NXT last successfully connected to.
getConstantIndex(ConstantRecord) - Method in class js.tinyvm.Binary
Get index of constant in binary by its constant record.
getConstantRecord(int) - Method in class js.tinyvm.Binary
Get constant record with given index.
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.
getCustomDataFlavor() - Method in class lejos.pc.tools.FileDrop.TransferableObject
Returns the custom DataFlavor associated with the encapsulated object or null if the FileDrop.TransferableObject.Fetcher constructor was used without passing a Class.
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
 
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
getDefaultProgram() - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to get the default program name
getDegrees() - Method in class lejos.nxt.addon.CompassHTSensor
Returns the directional heading in degrees.
getDegrees() - Method in class lejos.nxt.addon.CompassMindSensor
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.CompassHTSensor
Cartesian coordinate systems increase from 0 to 360 counter-clockwise, but Compass readings increase clockwise .
getDegreesCartesian() - Method in class lejos.nxt.addon.CompassMindSensor
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
 
getDescriptor() - Method in class js.tinyvm.Signature
 
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(float) - Method in class lejos.robotics.mapping.MapPanel
Convert a distance in map coordinates to a screen distance
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
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
getDynamicOffset() - Method in class lejos.nxt.addon.DIMUGyro
 
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
getEstimatedPose() - Method in class lejos.robotics.localization.MCLPoseProvider
 
getEstimatedPose() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a GET_ESTIMATED_POSE event to the NXT
getExceptions() - Method in class js.tinyvm.MethodRecord
 
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
getFeatures() - Method in class lejos.robotics.mapping.PCNavigationModel
Get the list of features
getFieldSize() - Method in class js.tinyvm.InstanceFieldRecord
 
getFile(int) - Method in class lejos.pc.tools.ExtendedFileModel
Get the FileInfo object for a specific file
getFile(File, String, int) - Method in class lejos.pc.tools.NXJBrowser
 
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.
getFiles() - Method in class lejos.pc.tools.FileDrop.Event
Returns an array of files that were dropped on a registered drop target.
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.NXJFirmwareInfo
Get the full firmware version
getFirmwareVersion() - Method in class lejos.nxt.remote.NXTCommand
Get the fimrware version.
getFirst() - Method in class js.tinyvm.InterfaceMap
Return the index of the first class implementing this interface.
getFlags() - Method in class js.tinyvm.MethodRecord
 
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
Method used by A* to calculate search score.
getGain() - Method in class lejos.util.KalmanFilter
 
getGeneration() - Method in class js.tinyvm.Binary
Return the current marking generation.
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 as reported by the GPS chip.
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
 
getImage() - Method in class js.tinyvm.Signature
 
getImageCreateString(byte[], Dimension, int) - Static method in class lejos.pc.tools.NXJImageConverter
 
getImageFromNxtImageCreateString(String, int) - Static method in class lejos.pc.tools.NXJImageConverter
 
getImageSize() - Method in class lejos.pc.tools.NXJImagePicturePanel
 
getInputStream(String) - Method in class js.tinyvm.ClassPath
 
getInputStream(String) - Method in interface js.tinyvm.IClassPath
Get input stream with the given class byte code.
getInputStream() - Method in class lejos.nxt.rcxcomm.RCXAbstractPort
Returns an input stream for this RCXPort.
getInputStream() - Method in class lejos.pc.charting.LoggerComms
Return the InputStream from the NXT.
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.
getInstance(int) - Static method in class lejos.nxt.SensorPort
 
getInstanceFieldOffset(String) - Method in class js.tinyvm.ClassRecord
 
getItems() - Method in class lejos.util.TextMenu
Returns list of items in this menu;
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
getKeyClickVolume() - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to get the master volume level
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.
getLastMove() - Method in class lejos.robotics.mapping.PCNavigationModel
Get the last move made by the robot
getLastOptVal(CommandLine, String) - Static method in class lejos.pc.tools.AbstractCommandLineParser
 
getLastOptVal(CommandLine, String, String) - Static method in class lejos.pc.tools.AbstractCommandLineParser
 
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.
getLatitude() - Method in class lejos.nxt.addon.GPSSensor
Read the current latitude as an integer value (decimal degrees times a million).
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
 
getLength() - Method in class js.tinyvm.ClassRecord
 
getLength() - Method in class js.tinyvm.CodeSequence
 
getLength() - Method in class js.tinyvm.ConstantRecord
Get length of this record.
getLength() - Method in class js.tinyvm.ConstantValue
Get length in bytes of value.
getLength() - Method in class js.tinyvm.EntryClassIndex
 
getLength() - Method in class js.tinyvm.ExceptionRecord
 
getLength() - Method in class js.tinyvm.InstanceFieldRecord
 
getLength() - Method in class js.tinyvm.InterfaceMap
return the number of bytes that make up this interface map.
getLength() - Method in class js.tinyvm.MasterRecord
Length.
getLength() - Method in class js.tinyvm.MethodRecord
 
getLength() - Method in class js.tinyvm.RecordTable
Length.
getLength() - Method in class js.tinyvm.StaticFieldRecord
 
getLength() - Method in class js.tinyvm.StaticValue
 
getLength() - Method in interface js.tinyvm.WritableData
Returns the length of the record, in bytes.
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.remote.RemoteMotor
RegulatedMotor for NXT need this
getLimitAngle() - Method in class lejos.robotics.MirrorMotor
 
getLimitAngle() - Method in interface lejos.robotics.RegulatedMotor
Return the limit angle (if any)
getLineNumber(int, int) - Method in class js.tinyvm.DebugData
 
getLines() - Method in class lejos.robotics.mapping.LineMap
Get the lines as an array
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
getLoggingChartPanel() - Method in class lejos.pc.charting.CustomChartPanel
 
getLongitude() - Method in class lejos.nxt.addon.GPSSensor
Read the current longitude as an integer value (decimal degrees times a million).
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.mapping.NavigationModel
Get the registered map
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
 
getMaxQueuedBytes() - Method in class lejos.pc.charting.CachingInputStream
Return the maximum number of bytes buffered.
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 class lejos.robotics.MirrorMotor
 
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.OmniPilot
 
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;
getMCL() - Method in class lejos.robotics.mapping.PCNavigationModel
Get the MCLPoseProvider associated with this model
getMean() - Method in class lejos.util.KalmanFilter
 
getMenuBar(JPanel) - Method in class lejos.pc.tools.NXJImageMainPanel
 
getMenuVersion() - Method in class lejos.nxt.remote.NXJFirmwareInfo
Get the full firmware version
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.tools.NXTNotFoundException
 
getMethodClass(int) - Method in class js.tinyvm.DebugData
 
getMethodCount() - Method in class js.tinyvm.DebugData
 
getMethodFilename(int) - Method in class js.tinyvm.DebugData
 
getMethodName(int) - Method in class js.tinyvm.DebugData
 
getMethodSignature(int) - Method in class js.tinyvm.DebugData
 
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.OmniPilot
 
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.ColorHTSensor
Returns the value of the mode control register (0x41)
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() - Method in class lejos.robotics.LightScanner
 
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.Navigator
Returns the MoveController belonging to this object.
getMoveDirection() - Method in class lejos.robotics.navigation.OmniPilot
Gets the move direction.
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.OmniPilot
 
getMovement() - Method in class lejos.robotics.navigation.SteeringPilot
 
getMovementIncrement() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getMovementIncrement() - Method in class lejos.robotics.navigation.SteeringPilot
 
getMoves() - Method in class lejos.robotics.mapping.PCNavigationModel
Get the moves made since the last setPose
getMoveSpeed() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. 
getMoveType() - Method in class lejos.robotics.navigation.Move
Get the type of the movement performed
getMultiplier() - Method in class lejos.nxt.addon.DIMUAccel
 
getMultiplier() - Method in enum lejos.nxt.addon.DIMUGyro.Range
 
getName() - Method in class js.tinyvm.ClassRecord
 
getName() - Method in class js.tinyvm.EntryClassIndex
 
getName() - Method in class js.tinyvm.InstanceFieldRecord
 
getName() - Method in class js.tinyvm.PrimitiveClassRecord
 
getName() - Method in class js.tinyvm.Signature
 
getName() - Method in class js.tinyvm.StaticFieldRecord
 
getName() - Method in class lejos.nxt.addon.LMotor
Get name from a RC Servo or a DC Motor
getName() - Method in class lejos.pc.tools.NXJLinkAndUploadCommandLineParser
 
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
 
getNodes() - Method in class lejos.robotics.mapping.PCNavigationModel
Get the generated node
getNormalized() - Method in class lejos.geom.Point
get a copy of this with length 1
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
getNumParameterWords() - Method in class js.tinyvm.MethodRecord
 
getNumParamWords(Method) - Static method in class js.tinyvm.MethodRecord
Number of parameter words, including this.
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
getNXJFirmwareInfo() - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to get the NXJ firmware and menu information
getNXJFirmwareVersion() - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to get the NXJ firmware version
getNxjHome() - Static method in class lejos.pc.comm.SystemContext
Deprecated.  
getNXJMenuVersion() - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to get the NXJ start-up menu version
getNXJProperties() - Static method in class lejos.pc.comm.NXTCommFactory
Load the leJOS NXJ properties
getNXTComm() - Method in class lejos.pc.comm.NXTConnector
 
getNxtImageData() - Method in class lejos.pc.tools.NXJImagePicturePanel
 
getNXTInfo() - Method in class lejos.pc.comm.NXTConnector
 
getObject() - Method in interface lejos.pc.tools.FileDrop.TransferableObject.Fetcher
Return the object being encapsulated in the FileDrop.TransferableObject.
getObjectColor(int) - Method in class lejos.nxt.addon.NXTCam
Get the color number for a tracked object
getObstacle() - Method in class lejos.nxt.addon.SumoEyesSensor
Returns the detected zone (NO_DETECTION (0) , RIGHT (1), CENTER (2), LEFT (3))
getOffset() - Method in class js.tinyvm.WritableDataWithOffset
Offset.
getOffsetCorrectionSpeed() - Method in class lejos.nxt.addon.DIMUGyro
 
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 class lejos.pc.charting.LoggerComms
Return the OutputStream to the NXT.
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
 
getParent() - Method in class js.tinyvm.ClassRecord
 
getParent() - Method in class js.tinyvm.PrimitiveClassRecord
 
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
getParticles() - Method in class lejos.robotics.mapping.NavigationModel
Get the registered particle set
getPath() - Method in class lejos.robotics.mapping.NavigationModel
Get the registered path
getPath() - Method in class lejos.robotics.navigation.Navigator
Gets the current path
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 - Variable in class lejos.robotics.mapping.NavigationPanel
 
getPose() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a GET_POSE event to the NXT
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.
getPose() - Method in class lejos.robotics.objectdetection.RangeFeature
 
getPoseProvider() - Method in class lejos.robotics.navigation.Navigator
Returns the PoseProvider
getPoses() - Method in class lejos.robotics.mapping.PCNavigationModel
Get the sequence of poses of the robot from moves sent from the NXT, since the last call of setPose
getPower() - Method in class lejos.nxt.addon.LnrActrFirgelliNXT
Returns the current actuator motor power setting.
getPower() - Method in class lejos.nxt.addon.MMXMotor
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.
getPower() - Method in interface lejos.robotics.LinearActuator
Returns the current actuator 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.
getPredictedCovariance() - Method in class lejos.util.KalmanFilter
 
getPredictedMean() - Method in class lejos.util.KalmanFilter
 
getPressure() - Method in class lejos.nxt.addon.DPressure250
Get the pressure reading in kilopascals
getPressure() - Method in class lejos.nxt.addon.DPressure500
Get the pressure reading in kilopascals
getPressure() - Method in interface lejos.robotics.PressureDetector
Get the pressure reading in kilopascals
getPrimitiveClass() - Method in class js.tinyvm.ClassRecord
Return the wrapped class if this class is a wrapper
getProductID() - Method in class lejos.nxt.addon.DIMUAccel
 
getProductID() - Method in class lejos.nxt.addon.DIMUGyro
 
getProductID() - Method in class lejos.nxt.addon.SensorMux
Method used to know the type of the sensor
getProductID() - Method in class lejos.nxt.I2CSensor
Read the sensor's product identifier.
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
getpulseWidth() - Method in interface lejos.robotics.Servo
Get the current PWM pulse width for the servo.
getRange() - Method in class lejos.nxt.addon.DIMUGyro
 
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.
getRateUnit() - Method in class lejos.nxt.addon.DIMUGyro
 
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.
getRawRate(int[]) - Method in class lejos.nxt.addon.DIMUGyro
 
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
getReadings(RangeReadings, RangeMap) - Method in class lejos.robotics.localization.MCLParticle
 
getReadings() - Method in class lejos.robotics.localization.MCLPoseProvider
Get the current range readings
getReadings() - Method in class lejos.robotics.mapping.NavigationModel
Get the current range readings
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.
getRemoteBattery() - Method in class lejos.robotics.mapping.PCNavigationModel
Get the remote battery voltage
getRemoteParticles() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a GET_PARTICLES event to the NXT
getRemoteReadings() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a GET_READINGS event to the NXT
getResult() - Method in class lejos.nxt.addon.NXTLineLeader
Get result value
getRGBComponent(int) - Method in class lejos.nxt.addon.ColorHTSensor
Returns a single color component, specified by using an enumeration constant as a parameter.
getRGBNormalized(int) - Method in class lejos.nxt.addon.ColorHTSensor
Returns the normalized color component.
getRGBRaw(int) - Method in class lejos.nxt.addon.ColorHTSensor
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
 
getRobotPose() - Method in class lejos.robotics.mapping.NavigationModel
Get the current pose of the robot
getRotateMaxSpeed() - Method in class lejos.robotics.navigation.DifferentialPilot
 
getRotateMaxSpeed() - Method in class lejos.robotics.navigation.OmniPilot
 
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 class lejos.robotics.navigation.OmniPilot
 
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 speed the motor is moving at.
getRotationSpeed() - Method in class lejos.nxt.addon.RCXRotationSensor
 
getRotationSpeed() - Method in class lejos.nxt.remote.RemoteMotor
 
getRotationSpeed() - Method in class lejos.robotics.MirrorMotor
 
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
getRow(String) - Method in class lejos.pc.tools.ExtendedFileModel
Return the row for a given file
getRowCount() - Method in class lejos.pc.tools.ExtendedFileModel
Get the number of rows in the model
getRowCount() - Method in class lejos.pc.tools.NXTConnectionModel
Return the number of rows
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
getRunTimeOptions() - Method in class js.tinyvm.MasterRecord
 
getSampleRate() - Method in class lejos.nxt.addon.DIMUGyro
 
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.  
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?
getSignatureId() - Method in class js.tinyvm.MethodRecord
 
getSimpleName() - Method in class js.tinyvm.ClassRecord
 
getSimpleName() - Method in class js.tinyvm.PrimitiveClassRecord
 
getSingleton() - Static method in class lejos.nxt.LCD
 
getSingleton() - Static method in class lejos.nxt.NXTFrame
Return the singleton frame.
getSingletonOpen() - Static method in class lejos.pc.comm.NXTCommandConnector
Ensure that the singleton NXTCommand object has been opened and return it.
getSize() - Method in class js.tinyvm.InterfaceMap
Return the number of "live" bits in the map.
getSleepTime() - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific method to get the menu sleep time
getSourceDistance() - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
return the shortest path length to this node from the start node
getSourceFilename() - Method in class js.tinyvm.ClassRecord
 
getSourceFilename() - Method in class js.tinyvm.PrimitiveClassRecord
 
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.PFMateMotor
returns the speed
getSpeed(int) - Method in class lejos.nxt.addon.RCXMotorMultiplexer
 
getSpeed() - Method in class lejos.nxt.remote.RemoteMotor
 
getSpeed() - Method in class lejos.robotics.MirrorMotor
 
getSpeed() - Method in interface lejos.robotics.RegulatedMotor
Returns the current motor speed.
getStaticFieldIndex(String) - Method in class js.tinyvm.ClassRecord
 
getStaticFieldOffset(String) - Method in class js.tinyvm.ClassRecord
 
getStaticFieldRecord(String) - Method in class js.tinyvm.ClassRecord
 
getStaticFieldRecord(String) - Method in class js.tinyvm.PrimitiveClassRecord
 
getStaticValue(String) - Method in class js.tinyvm.ClassRecord
 
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.LnrActrFirgelliNXT
Returns the absolute tachometer (encoder) position of the actuator shaft.
getTachoCount() - Method in class lejos.nxt.addon.MMXMotor
Returns the tachometer count.
getTachoCount() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Returns the tachometer count.
getTachoCount() - Method in class lejos.nxt.addon.RCXRotationSensor
Returns the tachometer count.
getTachoCount() - Method in class lejos.nxt.MotorPort
 
getTachoCount() - Method in class lejos.nxt.NXTMotor
 
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.
getTachoCount() - Method in interface lejos.robotics.LinearActuator
Returns the absolute tachometer (encoder) position of the actuator shaft.
getTachoCount() - Method in class lejos.robotics.MirrorMotor
 
getTarget() - Method in class lejos.robotics.mapping.NavigationModel
Get the target waypoint
getTemperatureUnit() - Method in class lejos.nxt.addon.DIMUGyro
 
getTiltUnit() - Method in class lejos.nxt.addon.DIMUAccel
Returns the current unit for tilt
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
 
getToolTipText(MouseEvent) - Method in class lejos.robotics.mapping.MapPanel
Get tooltips for individual features - currently just particles
getTotalNumExceptionRecords() - Method in class js.tinyvm.Binary
 
getTotalNumInstanceFields() - Method in class js.tinyvm.Binary
 
getTotalNumMethods() - Method in class js.tinyvm.Binary
 
getTransferData(DataFlavor) - Method in class lejos.pc.tools.FileDrop.TransferableObject
Returns the data encapsulated in this FileDrop.TransferableObject.
getTransferDataFlavors() - Method in class lejos.pc.tools.FileDrop.TransferableObject
Returns a two- or three-element array containing first the custom data flavor, if one was created in the constructors, second the default FileDrop.TransferableObject.DATA_FLAVOR associated with FileDrop.TransferableObject, and third the java.awt.datatransfer.DataFlavor.stringFlavor.
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.OmniPilot
 
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
 
getTypeIndex() - Method in class js.tinyvm.ConstantValue
Get type of this value.
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
getValue() - Method in enum js.tinyvm.DebugOptions
 
getValue() - Method in enum js.tinyvm.RunTimeOptions
 
getValue() - Method in class lejos.nxt.addon.SumoEyesSensor
Gets the raw value of the sensor.
getValueAt(int, int) - Method in class lejos.pc.tools.ExtendedFileModel
Get the object at the specified location
getValueAt(int, int) - Method in class lejos.pc.tools.NXTConnectionModel
Get the data in a specific cell
getValues() - Method in class lejos.pc.tools.NXJMonitor
 
getVelocity() - Method in class lejos.nxt.addon.GPSSensor
Read the current velocity in cm/s
getVendorID() - Method in class lejos.nxt.addon.DIMUAccel
 
getVendorID() - Method in class lejos.nxt.addon.DIMUGyro
 
getVendorID() - Method in class lejos.nxt.addon.SensorMux
Method used to know the Product ID
getVendorID() - Method in class lejos.nxt.I2CSensor
Read the sensor's vendor identifier.
getVersion() - Method in class lejos.nxt.addon.DIMUAccel
 
getVersion() - Method in class lejos.nxt.addon.DIMUGyro
 
getVersion() - Method in class lejos.nxt.addon.SensorMux
Method used to know the version
getVersion() - Method in class lejos.nxt.I2CSensor
Read the sensor's version string.
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 supplied to the NXTMMX
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.
getVolume() - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to get the master volume level
getWaypoint() - Method in class lejos.robotics.navigation.Navigator
Returns the waypoint to which the robot is presently moving.
getWaypoints() - Method in class lejos.robotics.mapping.PCNavigationModel
Get the list of waypoints
getWeight() - Method in class lejos.robotics.localization.MCLParticle
Return the weight of this particle
getX(float) - Method in class lejos.robotics.mapping.MapPanel
Get the screen X coordinate for a given map coordinate
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
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 class lejos.nxt.addon.CruizcoreGyro
 
getXAccel() - Method in class lejos.nxt.addon.DIMUAccel
 
getXAccel() - Method in interface lejos.robotics.Accelerometer
Measures the x-axis of the accelerometer, in meters/second^2.
getXRange() - Method in class lejos.robotics.localization.MCLPoseProvider
Returns the difference between max X and min X
getXTilt() - Method in class lejos.nxt.addon.AccelMindSensor
Tilt of sensor along X-axis (see top of Mindsensors.com sensor for diagram of axis).
getY(float) - Method in class lejos.robotics.mapping.MapPanel
Get the screen Y coordinate for a given map coordinate
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
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 class lejos.nxt.addon.CruizcoreGyro
 
getYAccel() - Method in class lejos.nxt.addon.DIMUAccel
 
getYAccel() - Method in interface lejos.robotics.Accelerometer
Measures the y-axis of the accelerometer, in meters/second^2.
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.AccelMindSensor
Returns Y tilt value (see top of Mindsensors.com sensor for diagram of axis).
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 class lejos.nxt.addon.CruizcoreGyro
 
getZAccel() - Method in class lejos.nxt.addon.DIMUAccel
 
getZAccel() - Method in interface lejos.robotics.Accelerometer
Measures the z-axis of the accelerometer, in meters/second^2.
getZTilt() - Method in class lejos.nxt.addon.AccelMindSensor
Returns Z tilt value (see top of Mindsensors.com sensor for diagram of axis).
goTo(Waypoint) - Method in class lejos.robotics.mapping.PCNavigationModel
Send a GOTO event to the NXT
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) - Method in class lejos.robotics.navigation.Navigator
Starts the robot moving toward the destination.
goTo(float, float) - Method in class lejos.robotics.navigation.Navigator
Starts the moving toward the destination Waypoint created from the parameters.
goTo(float, float, float) - Method in class lejos.robotics.navigation.Navigator
Starts the moving toward the destination Waypoint created from the parameters.
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.
GRID_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
GRID_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
gridColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
GridNode - Class in lejos.robotics.pathfinding
 
GridNode(float, float, float) - Constructor for class lejos.robotics.pathfinding.GridNode
 
gridSize - Variable in class lejos.robotics.mapping.MapPanel
 
gridSizeField - Variable in class lejos.robotics.mapping.NavigationPanel
 
gridSizeLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
gridSpace - Variable in class lejos.robotics.mapping.PCNavigationModel
 
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(Gyroscope) - Constructor for class lejos.nxt.addon.GyroDirectionFinder
Creates and initializes a new GyroDirectionFinder using passed GyroSensor
GyroDirectionFinder(Gyroscope, 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

halt() - Method in class lejos.robotics.LightScanner
 
HANDLE_ALREADY_CLOSED - Static variable in class lejos.nxt.remote.ErrorMessages
 
hasDirection() - Method in class lejos.nxt.addon.IRSeekerV2
 
hashCode() - Method in class js.tinyvm.ClassRecord
 
hashCode() - Method in class js.tinyvm.ConstantRecord
hashCode based on referenced value.
hashCode() - Method in class js.tinyvm.ExceptionRecord
 
hashCode() - Method in class js.tinyvm.InstanceFieldRecord
 
hashCode() - Method in class js.tinyvm.MethodRecord
 
hashCode() - Method in class js.tinyvm.Signature
 
hashCode() - Method in class js.tinyvm.StaticFieldRecord
 
hashCode() - Method in class js.tinyvm.StaticValue
 
HashVector<T> - Class in js.tinyvm.util
 
HashVector() - Constructor for class js.tinyvm.util.HashVector
 
hasMain(String) - Method in class js.tinyvm.Binary
Has class in binary a public static void main (String[] args) method?
hasMap() - Method in class lejos.robotics.mapping.NavigationModel
Test is the model has a map registered
hasMethod(Signature, boolean) - Method in class js.tinyvm.ClassRecord
(Call only after record has been processed).
hasMethod(Signature, boolean) - Method in class js.tinyvm.PrimitiveClassRecord
(Call only after record has been processed).
hasParent() - Method in class js.tinyvm.ClassRecord
 
hasParent() - Method in class js.tinyvm.PrimitiveClassRecord
 
hasPic() - Method in class lejos.pc.tools.NXJImagePicturePanel
 
hasReference() - Method in class js.tinyvm.ClassRecord
 
hasReference() - Method in class js.tinyvm.PrimitiveClassRecord
 
hasStaticInitializer() - Method in class js.tinyvm.ClassRecord
 
hasStaticInitializer() - Method in class js.tinyvm.PrimitiveClassRecord
 
head - Variable in class lejos.robotics.LightScanner
 
head - Variable in class lejos.robotics.RotatingRangeScanner
 
heading - Variable in class lejos.robotics.navigation.Waypoint
 
headingRequired - Variable in class lejos.robotics.navigation.Waypoint
 
headMotorBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
headMotorLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
HIGH_SPEED - Static variable in interface lejos.nxt.I2CPort
Use high speed I/O (125KHz)
HIGH_SPEED_BUFFER - Static variable in interface lejos.nxt.remote.NXTProtocol
 
HTANGLE_MODE_CALIBRATE - Static variable in class lejos.nxt.addon.AngleSensor
 
HTANGLE_MODE_RESET - Static variable in class lejos.nxt.addon.AngleSensor
 

I

I - Variable in class lejos.nxt.addon.DIMUGyro
 
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
 
IByteWriter - Interface in js.tinyvm.io
 
IClassPath - Interface in js.tinyvm
Interface for class paths.
ID_ENTER - Static variable in class lejos.nxt.Button
 
ID_ESCAPE - Static variable in class lejos.nxt.Button
 
ID_LEFT - Static variable in class lejos.nxt.Button
 
ID_RIGHT - Static variable in class lejos.nxt.Button
 
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 class lejos.nxt.remote.ErrorMessages
 
ILLEGAL_HANDLE - Static variable in class lejos.nxt.remote.ErrorMessages
 
ILLEGAL_MAILBOX_QUEUE_ID_SPECIFIED - Static variable in class lejos.nxt.remote.ErrorMessages
 
ILLEGAL_SIZE_SPECIFIED - Static variable in class lejos.nxt.remote.ErrorMessages
 
IMAGE_UPDATE_PROP - Static variable in class lejos.pc.tools.NXJImagePicturePanel
 
impulseMove(int, int) - Method in class lejos.robotics.navigation.Ballbot
Causes movement along either the xaxis or y axis.
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
indexOf(T) - Method in class js.tinyvm.RecordTable
Get index of writable element.
indexOf(Object) - Method in class js.tinyvm.util.HashVector
 
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.ColorHTSensor
Puts the sensor into black/ambient level calibration mode.
initFlags() - Method in class js.tinyvm.ClassRecord
 
initFlags() - Method in class js.tinyvm.MethodRecord
 
INITIAL_COLORS - Variable in class lejos.robotics.mapping.MapPanel
 
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
 
initialViewStart - Variable in class lejos.robotics.mapping.NavigationPanel
 
initOffset(int) - Method in class js.tinyvm.RecordTable
Init offset of record table and all of its elements.
initOffset(int) - Method in class js.tinyvm.WritableDataWithOffset
Init offset.
initOffsets() - Method in class js.tinyvm.Binary
 
initParent() - Method in class js.tinyvm.ClassRecord
 
initWhiteBalance() - Method in class lejos.nxt.addon.ColorHTSensor
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
INSANE_PACKET - Static variable in class lejos.nxt.remote.ErrorMessages
 
insertElementAt(T, int) - Method in class js.tinyvm.util.HashVector
Deprecated. method is to be removed since it messes up indices
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.
InstanceFieldRecord - Class in js.tinyvm
 
InstanceFieldRecord(Field) - Constructor for class js.tinyvm.InstanceFieldRecord
 
instanceUsed() - Method in class js.tinyvm.ClassRecord
 
INSUFFICIENT_MEMORY_AVAILABLE - Static variable in class lejos.nxt.remote.ErrorMessages
 
Integration - Class in lejos.util
Integrate sensor measurement over time, e.g.
Integration(double, double) - Constructor for class lejos.util.Integration
Create the integration object with the initial value for the integral value and the initial reading.
InterfaceMap - Class in js.tinyvm
This class provides a represntation of an interface map.
InterfaceMap(Binary, ClassRecord) - Constructor for class js.tinyvm.InterfaceMap
 
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
invertMotor(RegulatedMotor) - Static method in class lejos.robotics.MirrorMotor
Returns an inverted RegulatedMotor.
invertMotor(EncoderMotor) - Static method in class lejos.robotics.MirrorMotor
Returns an inverted EncoderMotor.
IOUtilities - Class in js.tinyvm.io
Helper class for padding.
IOUtilities() - Constructor for class js.tinyvm.io.IOUtilities
 
IRLink - Class in lejos.nxt.addon
Supports for HiTechnic NXT IRLink Sensor (NIL1046) IRLink.
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
isArray() - Method in class js.tinyvm.ClassRecord
 
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.
isBlocked(ShortestPathFinder.Node) - Method in class lejos.robotics.pathfinding.ShortestPathFinder.Node
 
isBluetooth() - Method in class lejos.pc.tools.NXJLinkAndUploadCommandLineParser
 
isBusy() - Method in class lejos.robotics.localization.MCLPoseProvider
returns true if particle weights are being updated.
isCalibrated - Variable in class lejos.nxt.remote.InputValues
 
isCalled() - Method in class js.tinyvm.MethodRecord
 
isCanceled() - Method in class js.common.NullToolProgressMonitor
 
isCanceled() - Method in interface js.common.ToolProgressMonitor
Is tool canceled?.
isCanceled() - Method in class lejos.pc.tools.CLIToolProgressMonitor
 
isCellEditable(int, int) - Method in class lejos.pc.tools.ExtendedFileModel
Check if a cell is editable
isConnected() - Method in class lejos.pc.charting.LoggerComms
Is there a current valid connection?
isConnected() - Method in class lejos.robotics.mapping.PCNavigationModel
Test if a NXT brick is currently connected
isConstructor() - Method in class js.tinyvm.Signature
 
isDataFlavorSupported(DataFlavor) - Method in class lejos.pc.tools.FileDrop.TransferableObject
Returns true if flavor is one of the supported flavors.
isDataOverrun() - Method in class lejos.nxt.addon.DIMUGyro
 
isDown() - Method in class lejos.nxt.Button
 
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
isHeadingRequired() - Method in class lejos.robotics.navigation.Waypoint
 
isInitializer() - Method in class js.tinyvm.Signature
 
isInterface() - Method in class js.tinyvm.ClassRecord
 
isInterface() - Method in class js.tinyvm.PrimitiveClassRecord
 
isLongRange() - Method in class lejos.nxt.addon.SumoEyesSensor
Returns the current range of the sensor.
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.LMotor
Method to know if Servo is moving to a determinated angle
isMoving() - Method in class lejos.nxt.addon.LnrActrFirgelliNXT
Returns true if the actuator is in motion.
isMoving() - Method in class lejos.nxt.addon.MMXMotor
This method returns true if the motor has been commanded with the forward() or backward() methods.
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.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 interface lejos.robotics.LinearActuator
Return true if the actuator is in motion due to a move() or moveTo() order.
isMoving() - Method in class lejos.robotics.MirrorMotor
 
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.Navigator
Returns true if the robot is moving toward a waypoint.
isMoving() - Method in class lejos.robotics.navigation.OmniPilot
 
isMoving() - Method in class lejos.robotics.navigation.SteeringPilot
 
isNewDataAvailable() - Method in class lejos.nxt.addon.DIMUGyro
Returns true if new data is available from the sensor
isNonsingular() - Method in class lejos.util.LUDecomposition
Is the matrix nonsingular?
isOpen() - Method in class lejos.nxt.remote.NXTCommand
Test is connection is open
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.Button
Deprecated. use Button.isDown() instead
isPressed(int) - Static method in class lejos.nxt.NXTFrame
Test if a button or set of buttons is pressed If they are unset them, and return true
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.
isPrimitive() - Method in class js.tinyvm.ClassRecord
 
isRotating() - Method in class lejos.nxt.remote.RemoteMotor
CURRENTLY NOT IMPLEMENTED! Use isMoving() for now.
isRun() - Method in class lejos.pc.tools.NXJLinkAndUploadCommandLineParser
 
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
isSpecialSignature(Signature) - Method in class js.tinyvm.Binary
 
isStalled() - Method in class lejos.nxt.addon.LnrActrFirgelliNXT
Returns true if a move() or moveTo() order ended due to a motor stall.
isStalled() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Return true if the motor has stalled after a motor action method was executed.
isStalled() - Method in class lejos.nxt.remote.RemoteMotor
 
isStalled() - Method in interface lejos.robotics.LinearActuator
Returns true if a move() or moveTo() order ended due to a stalled motor.
isStalled() - Method in class lejos.robotics.MirrorMotor
 
isStalled() - Method in class lejos.robotics.navigation.DifferentialPilot
 
isStalled() - Method in interface lejos.robotics.RegulatedMotor
returns true if motor is stalled
isStaticInitializer() - Method in class js.tinyvm.Signature
 
isStop() - Method in class lejos.nxt.addon.PFMateMotor
Determines if motor is stopped this is based on what the receiver has in its registers
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
isUSB() - Method in class lejos.pc.tools.NXJLinkAndUploadCommandLineParser
 
isValid(byte) - Static method in class js.tinyvm.TinyVMType
Is the given byte a valid tiny vm type?
isWrapper() - Method in class js.tinyvm.ClassRecord
Determine if this class is a wrapper
iterator() - Method in class js.tinyvm.RecordTable
Iterator.

J

js.common - package js.common
 
js.tinyvm - package js.tinyvm
 
js.tinyvm.io - package js.tinyvm.io
 
js.tinyvm.util - package js.tinyvm.util
 
jump(int) - Method in class lejos.pc.comm.NXTSamba
Start execution of code at the specified address.

K

KalmanFilter - Class in lejos.util
Implementation of a Kalman filter using the Matrix class
KalmanFilter(Matrix, Matrix, Matrix, Matrix, Matrix) - Constructor for class lejos.util.KalmanFilter
 
KEEP_ALIVE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
KEY_DEFAULT_MAP - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_DEFAULT_NXT - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_DETECTOR_DELAY - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_DETECTOR_MAX_DISTANCE - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_DIFF_PILOT_LEFT_MOTOR - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_DIFF_PILOT_REVERSE - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_DIFF_PILOT_RIGHT_MOTOR - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_DIFF_PILOT_TRACK_WIDTH - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_DIFF_PILOT_WHEEL_DIAMETER - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_LEFTMOTOR - Static variable in class lejos.util.PilotProps
 
KEY_MAX_ROTATE_SPEED - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_MAX_TRAVEL_SPEED - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_MCL_CLEARANCE - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_MCL_NUM_PARTICLES - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_MESH_CLEARANCE - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_MESH_GRID_SIZE - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_RANDOM_MOVE_CLEARANCE - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_RANDOM_MOVE_MAX_DISTANCE - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_RANGE_SCANNER_GEAR_RATIO - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_RANGE_SCANNER_HEAD_MOTOR - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_REVERSE - Static variable in class lejos.util.PilotProps
 
KEY_RIGHTMOTOR - Static variable in class lejos.util.PilotProps
 
KEY_STEER_PILOT_DRIVE_MOTOR - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_STEER_PILOT_DRIVE_MOTOR_REVERSE - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_STEER_PILOT_LEFT_TACHO - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_STEER_PILOT_RIGHT_TACHO - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_STEER_PILOT_STEERING_MOTOR - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_STEER_PILOT_WHEEL_DIAMETER - Static variable in class lejos.robotics.mapping.NavigationPanel
 
KEY_TRACKWIDTH - Static variable in class lejos.util.PilotProps
 
KEY_WHEELDIAMETER - Static variable in class lejos.util.PilotProps
 

L

label - Variable in class lejos.robotics.mapping.SliderPanel
 
label1 - Variable in class lejos.robotics.mapping.EventPanel
 
label2 - Variable in class lejos.robotics.mapping.EventPanel
 
label3 - Variable in class lejos.robotics.mapping.EventPanel
 
LabeledGauge - Class in lejos.pc.tools
A Swing JPanel that displays a gauge with a label
LabeledGauge(String, int) - Constructor for class lejos.pc.tools.LabeledGauge
Create the labeled gauge
LampLightDetector - Interface in lejos.robotics
Interface for a light sensor that also includes a lamp (usually LED) to provide illumination.
lastMove - Variable in class lejos.robotics.mapping.NavigationModel
 
lastMoveField - Variable in class lejos.robotics.mapping.NavigationPanel
 
lastMovePanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
lastPlannedMove - Variable in class lejos.robotics.mapping.NavigationModel
 
LCD - Class in lejos.nxt
PC emulation of the LCD class
LCD_HEIGHT - Static variable in class lejos.nxt.LCD
 
LCD_WIDTH - Static variable in class lejos.nxt.LCD
 
LCDDisplay - Class in lejos.pc.tools
 
LCDDisplay() - Constructor for class lejos.pc.tools.LCDDisplay
 
LCP - Static variable in interface lejos.pc.comm.NXTComm
Lego Communications Protocol (LCP) I/O mode.
lcpClose() - Method in class lejos.robotics.mapping.PCNavigationModel
Close the LCP connection to the NXT
lcpConnect(String) - Method in class lejos.robotics.mapping.PCNavigationModel
Make an LCP connection to the NXT
lcpErrorToString(byte) - Static method in class lejos.nxt.remote.ErrorMessages
 
LCPException - Exception in lejos.nxt.remote
 
LCPException() - Constructor for exception lejos.nxt.remote.LCPException
 
LCPException(String) - Constructor for exception lejos.nxt.remote.LCPException
 
LCPException(byte) - Constructor for exception lejos.nxt.remote.LCPException
 
LCPException(String, Throwable) - Constructor for exception lejos.nxt.remote.LCPException
 
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
 
LEByteWriter - Class in js.tinyvm.io
Writes lo-byte first, hi-byte last.
LEByteWriter(OutputStream) - Constructor for class js.tinyvm.io.LEByteWriter
 
LEFT - Static variable in class lejos.nxt.addon.SumoEyesSensor
The Constant LEFT (1).
LEFT - Static variable in class lejos.nxt.Button
* The Left button.
leftMotorBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
leftMotorLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
leftOrth() - Method in class lejos.geom.Point
calculate left orthogonal vector of this
leftTachoField - Variable in class lejos.robotics.mapping.NavigationPanel
 
leftTachoLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.charting - package lejos.pc.charting
 
lejos.pc.comm - package lejos.pc.comm
Communication from the PC to the NXT
lejos.pc.tools - package lejos.pc.tools
 
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.robotics.subsumption - package lejos.robotics.subsumption
Support for subsumption architecture.
lejos.util - package lejos.util
More utility classes
length() - Method in class lejos.geom.Line
Return the length of the line
length() - Method in class lejos.geom.Point
Returns the length of this vector
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.
LightScanner - Class in lejos.robotics
Software abstraction of a light sensor rotating in a horizontal plane, driven by a motor.
LightScanner(RegulatedMotor, LightDetector, int, int) - Constructor for class lejos.robotics.LightScanner
Specify the hardware for this object.
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 - Interface in lejos.robotics
Interface that defines the minimal implementation for a Linear Actuator device.
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
link(String, String[], boolean, OutputStream, boolean, int, int, OutputStream) - Method in class js.tinyvm.TinyVMTool
Execute tiny vm.
link(String, String[], boolean, int, int) - Method in class js.tinyvm.TinyVMTool
Link classes.
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
 
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
LnrActrFirgelliNXT - Class in lejos.nxt.addon
A Linear Actuator class that provides blocking and non-blocking move actions with stall detection.
LnrActrFirgelliNXT(EncoderMotor) - Constructor for class lejos.nxt.addon.LnrActrFirgelliNXT
Create a LnrActrFirgelliNXT instance.
LnrActrFirgelliNXT(TachoMotorPort) - Constructor for class lejos.nxt.addon.LnrActrFirgelliNXT
Convenience constructor that creates an instance of a NXTMotor using the specified motor port.
load(InputStream) - Static method in class js.tinyvm.DebugData
 
load(File) - Static method in class js.tinyvm.DebugData
 
load() - Method in class lejos.nxt.addon.DIMUAccel
Loads saved offset and scale values from memory.
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
loadMap(String) - Method in class lejos.robotics.mapping.PCNavigationModel
 
loadMap(String, int) - Method in class lejos.robotics.mapping.PCNavigationModel
Load a line map and send it to the PC
loadMapButton - Variable in class lejos.robotics.mapping.NavigationPanel
 
loadObject(DataInputStream) - Method in class lejos.robotics.localization.MCLParticleSet
Load serialized particles from a data input stream
loadObject(DataInputStream) - Method in class lejos.robotics.localization.MCLPoseProvider
Load serialized estimated pose from a data input stream
loadObject(DataInputStream) - Method in class lejos.robotics.mapping.LineMap
Load a map from a DataInputStream
loadObject(DataInputStream) - Method in class lejos.robotics.navigation.Move
 
loadObject(DataInputStream) - Method in class lejos.robotics.navigation.Pose
 
loadObject(DataInputStream) - Method in class lejos.robotics.navigation.Waypoint
 
loadObject(DataInputStream) - Method in class lejos.robotics.objectdetection.RangeFeature
 
loadObject(DataInputStream) - Method in class lejos.robotics.pathfinding.Path
 
loadObject(DataInputStream) - Method in class lejos.robotics.RangeReadings
Load the readings from a DataInputStream
loadObject(DataInputStream) - Method in interface lejos.robotics.Transmittable
 
loadPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
loadPersistentValues() - Method in class lejos.util.PilotProps
 
loadProperties() - Method in class lejos.robotics.mapping.NavigationPanel
 
localize - Variable in class lejos.robotics.mapping.NavigationPanel
 
localize() - Method in class lejos.robotics.mapping.PCNavigationModel
Tell the NXT to keep making random moves until the robot is localized
lock() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Locks the motor in current position.
log(String) - Method in class js.common.NullToolProgressMonitor
 
log(String) - Method in interface js.common.ToolProgressMonitor
Notification about some progress information.
log(ToolProgressMonitor) - Method in class js.tinyvm.Binary
 
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
log(String) - Method in class lejos.pc.tools.CLIToolProgressMonitor
 
log(String) - Method in interface lejos.robotics.mapping.MapApplicationUI
Log a progress message
log(String) - Method in class lejos.robotics.mapping.NavigationPanel
Log a message
logCommentReceived(int, String) - Method in interface lejos.pc.charting.LoggerListener
Invoked when a comment is logged.
logEvent(String) - Method in interface lejos.pc.comm.NXTCommLogListener
 
logEvent(Throwable) - Method in interface lejos.pc.comm.NXTCommLogListener
 
logEvent(String) - Method in class lejos.pc.tools.ToolsLogger
 
logEvent(Throwable) - Method in class lejos.pc.tools.ToolsLogger
 
logFieldNamesChanged(String[]) - Method in interface lejos.pc.charting.LoggerListener
Invoked when the log field headers are initially set or changed.
LoggerComms - Class in lejos.pc.charting
Provides a general connection manager on the PC that provides an InputStream and OutputStream from/to the NXTDataLogger running on the NXT.
LoggerComms() - Constructor for class lejos.pc.charting.LoggerComms
Create a LoggerComms instance
LoggerListener - Interface in lejos.pc.charting
Change listener to notify of events when log data has been recieved, a data stream EOF has occurred, a comment has been received, and header defs have been changed by the NXT-side lejos.util.NXTDataLogger.
LoggerProtocolManager - Class in lejos.pc.charting
This class provides the communications protocol manager for receiving and processing messages from the lejos.util.NXTDataLogger class.
LoggerProtocolManager(InputStream, OutputStream) - Constructor for class lejos.pc.charting.LoggerProtocolManager
Create a LoggerProtocolManager instance.
logLineAvailable(DataItem[]) - Method in interface lejos.pc.charting.LoggerListener
Invoked when a log line [whose fields are defined in NXTDataLogger.setColumns()] is logged and NXTDataLogger.finishLine() is invoked.
logMessage(String) - Method in class lejos.pc.tools.ConsoleViewerSwingUI
Log a progress message
logMessage(String) - Method in interface lejos.pc.tools.ConsoleViewerUI
 
logMessage(String) - Method in interface lejos.pc.tools.DataViewerUI
 
logMessage(String) - Method in class lejos.pc.tools.NXJConsole
 
logMessage(String) - Method in class lejos.pc.tools.NXJConsoleViewer
Log a progress message
logMessage(String) - Method in class lejos.pc.tools.NXJControl
Used for console viewer
logMessage(String) - Method in class lejos.pc.tools.NXJDataViewer
Log a message to System.out
logPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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

M_ARGS_SHIFT - Static variable in class js.tinyvm.TinyVMConstants
 
M_NATIVE - Static variable in class js.tinyvm.TinyVMConstants
 
M_SIG_MASK - Static variable in class js.tinyvm.TinyVMConstants
 
M_STATIC - Static variable in class js.tinyvm.TinyVMConstants
 
M_SYNCHRONIZED - Static variable in class js.tinyvm.TinyVMConstants
 
MAGENTA - Static variable in class lejos.robotics.Color
 
MAGIC_MASK - Static variable in class js.tinyvm.TinyVMConstants
 
MagneticSensor - Class in lejos.nxt.addon
Support for HiTechnic Magnetic sensor
MagneticSensor(ADSensorPort) - Constructor for class lejos.nxt.addon.MagneticSensor
 
MagneticSensor(ADSensorPort, int) - Constructor for class lejos.nxt.addon.MagneticSensor
 
main(String[]) - Static method in class js.tinyvm.TinyVM
Deprecated.  
main(String[]) - Static method in class lejos.pc.tools.Console
Deprecated.  
main(String[]) - Static method in class lejos.pc.tools.ConsoleViewer
Deprecated.  
main(String[]) - Static method in class lejos.pc.tools.DataViewer
Deprecated.  
main(String[]) - Static method in class lejos.pc.tools.NXJBrowser
 
main(String[]) - Static method in class lejos.pc.tools.NXJChartingLogger
 
main(String[]) - Static method in class lejos.pc.tools.NXJConsole
 
main(String[]) - Static method in class lejos.pc.tools.NXJConsoleViewer
Initialize the display Frame
main(String[]) - Static method in class lejos.pc.tools.NXJControl
Command line entry point
main(String[]) - Static method in class lejos.pc.tools.NXJDataViewer
Initialize the display Frame
main(String[]) - Static method in class lejos.pc.tools.NXJDebugTool
 
main(String[]) - Static method in class lejos.pc.tools.NXJFlash
 
main(String[]) - Static method in class lejos.pc.tools.NXJFlashG
 
main(String[]) - Static method in class lejos.pc.tools.NXJImage
 
main(String[]) - Static method in class lejos.pc.tools.NXJLink
Main entry point for command line usage.
main(String[]) - Static method in class lejos.pc.tools.NXJLinkAndUpload
Main entry point for command line usage
main(String[]) - Static method in class lejos.pc.tools.NXJMapCommand
Create a MapTest object and display it in a GUI frame.
main(String[]) - Static method in class lejos.pc.tools.NXJMonitor
 
main(String[]) - Static method in class lejos.pc.tools.NXJSocketProxy
 
main(String[]) - Static method in class lejos.pc.tools.NXJUpload
Main entry point
main(String[]) - Static method in class lejos.pc.tools.SocketProxy
Deprecated.  
makeLeftOrth() - Method in class lejos.geom.Point
Turns this vector into its left-handed cartesian orthagonal
makeRightOrth() - Method in class lejos.geom.Point
Turns this vector into its right-handed cartesian orthagonal
map - Variable in class lejos.robotics.mapping.NavigationModel
 
MAP_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
MAP_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
MapApplicationUI - Interface in lejos.robotics.mapping
 
mapColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
mapFileField - Variable in class lejos.robotics.mapping.NavigationPanel
 
mapFileLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
mapLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
mapMenu - Variable in class lejos.robotics.mapping.NavigationPanel
 
MapPanel - Class in lejos.robotics.mapping
 
MapPanel(PCNavigationModel, Dimension, NavigationPanel) - Constructor for class lejos.robotics.mapping.MapPanel
Create the panel, set its size, and associated it with the navigation model and navigation panel.
mapPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
mapPaneSize - Variable in class lejos.robotics.mapping.NavigationPanel
 
markArray(int) - Method in class js.tinyvm.CodeUtilities
Mark an array as being used.
markCalled(JavaClass, Binary) - Method in class js.tinyvm.MethodRecord
 
markClass(int) - Method in class js.tinyvm.CodeUtilities
Mark the class as being used.
markClassUsed(ClassRecord, boolean) - Method in class js.tinyvm.Binary
Mark the given class as actually used.
markInstanceUsed() - Method in class js.tinyvm.ClassRecord
 
markMethod(MethodRecord, boolean) - Method in class js.tinyvm.ClassRecord
 
markMethod(MethodRecord, boolean) - Method in class js.tinyvm.PrimitiveClassRecord
 
markMethods() - Method in class js.tinyvm.ClassRecord
 
markMethods() - Method in class js.tinyvm.PrimitiveClassRecord
 
markPrimitiveArray(byte) - Method in class js.tinyvm.CodeUtilities
Mark a primitive array as being used.
markUsed(String[]) - Method in class js.tinyvm.Binary
 
markUsed() - Method in class js.tinyvm.ClassRecord
 
markUsed() - Method in class js.tinyvm.ConstantRecord
 
markUsed() - Method in class js.tinyvm.ConstantValue
 
markUsed() - Method in class js.tinyvm.StaticFieldRecord
 
MasterRecord - Class in js.tinyvm
Master record.
MasterRecord(Binary) - Constructor for class js.tinyvm.MasterRecord
Constructor.
Matrix - Class in lejos.util
Matrix implementation derived from the JAMA project
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_CLASSES - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_CLUSTER_SIZE - Static variable in class lejos.robotics.mapping.MapPanel
 
MAX_CODE - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_CONSTANTS - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_DIMS - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_EXCEPTION_HANDLERS - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_FIELD_OFFSET - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_FIELDS - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_FILENAMELENGTH - Static variable in class lejos.nxt.remote.NXTCommand
 
MAX_FILES - Static variable in class lejos.pc.tools.ExtendedFileModel
 
MAX_FILES - Static variable in class lejos.pc.tools.NXJBrowser
 
MAX_IO - Static variable in interface lejos.nxt.I2CPort
Maximum read/write request length
MAX_LOCALS - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_METHODS - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_OPERANDS - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_OPTIMIZED_STRING - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_PARAMETER_WORDS - Static variable in class js.tinyvm.TinyVMConstants
 
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_SIGNATURES - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_STATICS - Static variable in class js.tinyvm.TinyVMConstants
 
MAX_TYPE - Static variable in interface lejos.nxt.SensorConstants
 
maxDistanceField - Variable in class lejos.robotics.mapping.NavigationPanel
 
maxDistanceLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
maxDistField - Variable in class lejos.robotics.mapping.NavigationPanel
 
maxDistLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
 
maxZoom - Variable in class lejos.robotics.mapping.NavigationPanel
 
mcl - Variable in class lejos.robotics.mapping.NavigationModel
 
mcl - Variable in class lejos.robotics.mapping.NavigationPanel
 
mclForm - Variable in class lejos.robotics.mapping.NavigationPanel
 
mclOKButton - Variable in class lejos.robotics.mapping.NavigationPanel
 
mclPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.
MCLPoseProvider(RangeMap, int, int) - Constructor for class lejos.robotics.localization.MCLPoseProvider
Constructor for use on PC
MenuAction - Class in lejos.robotics.mapping
Implements context menu by calling method to send events to the NXT.
MenuAction(NavigationModel.NavEvent, String, Point, PCNavigationModel, NavigationPanel) - Constructor for class lejos.robotics.mapping.MenuAction
 
menuBar - Variable in class lejos.robotics.mapping.NavigationPanel
 
menuMajorVersion - Variable in class lejos.nxt.remote.NXJFirmwareInfo
 
menuMinorVersion - Variable in class lejos.nxt.remote.NXJFirmwareInfo
 
menuPatchLevel - Variable in class lejos.nxt.remote.NXJFirmwareInfo
 
menuRevision - Variable in class lejos.nxt.remote.NXJFirmwareInfo
 
mesh - Variable in class lejos.robotics.mapping.PCNavigationModel
 
MESH_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
MESH_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
meshColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
meshPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
message(String) - Method in class lejos.pc.tools.NXJFlash
 
message(String) - Method in interface lejos.pc.tools.NXJFlashUI
Output a status message about an ongoing operation.
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.
MethodRecord - Class in js.tinyvm
 
MethodRecord(Method, Signature, ClassRecord, Binary, RecordTable<RecordTable<ExceptionRecord>>, HashVector<Signature>) - Constructor for class js.tinyvm.MethodRecord
 
MIME_TYPE - Static variable in class lejos.pc.tools.FileDrop.TransferableObject
The MIME type for FileDrop.TransferableObject.DATA_FLAVOR is application/x-net.iharder.dnd.TransferableObject.
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
minZoom - Variable in class lejos.robotics.mapping.NavigationPanel
 
MirrorMotor - Class in lejos.robotics
This class returns a motor that rotates in the reverse direction of a regular motor.
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.
MMXMotor - Class in lejos.nxt.addon
Abstraction to drive a basic encoder motor with the NXTMMX motor multiplexer.
MMXMotor(NXTMMX, int) - Constructor for class lejos.nxt.addon.MMXMotor
Create an instance of a MMXMotor.
MMXRegulatedMotor - Class in lejos.nxt.addon
Abstraction to drive a regulated encoder motor with the 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_ANGLESTEP - Static variable in class lejos.pc.tools.NXJMonitor
 
MODE_BOOLEAN - Static variable in interface lejos.nxt.SensorConstants
 
MODE_BOOLEAN - Static variable in class lejos.pc.tools.NXJMonitor
 
MODE_CAPTURE - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_CELSIUS - Static variable in interface lejos.nxt.SensorConstants
 
MODE_CELSIUS - Static variable in class lejos.pc.tools.NXJMonitor
 
MODE_CONTINUOUS - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_FARENHEIT - Static variable in interface lejos.nxt.SensorConstants
 
MODE_FARENHEIT - Static variable in class lejos.pc.tools.NXJMonitor
 
MODE_OFF - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_PCTFULLSCALE - Static variable in interface lejos.nxt.SensorConstants
 
MODE_PCTFULLSCALE - Static variable in class lejos.pc.tools.NXJMonitor
 
MODE_PERIODCOUNTER - Static variable in interface lejos.nxt.SensorConstants
 
MODE_PERIODCOUNTER - Static variable in class lejos.pc.tools.NXJMonitor
 
MODE_PING - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_RAW - Static variable in interface lejos.nxt.SensorConstants
 
MODE_RAW - Static variable in class lejos.pc.tools.NXJMonitor
 
MODE_REG - Static variable in class lejos.nxt.addon.DIMUAccel
 
MODE_RESET - Static variable in class lejos.nxt.UltrasonicSensor
 
MODE_TRANSITIONCNT - Static variable in interface lejos.nxt.SensorConstants
 
MODE_TRANSITIONCNT - Static variable in class lejos.pc.tools.NXJMonitor
 
model - Variable in class lejos.robotics.mapping.EventPanel
 
model - Variable in class lejos.robotics.mapping.MapPanel
 
model - Variable in class lejos.robotics.mapping.MenuAction
 
model - Variable in class lejos.robotics.mapping.NavigationPanel
 
model - Variable in class lejos.robotics.mapping.SliderPanel
 
modeLabel - Variable in class lejos.pc.tools.NXJImageMainPanel
 
MODEMASK - Static variable in interface lejos.nxt.remote.NXTProtocol
 
MODULE_NOT_FOUND - Static variable in class lejos.nxt.remote.ErrorMessages
 
Motor - Class in lejos.nxt
Motor class.
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
 
motors - Variable in class lejos.robotics.mapping.NavigationPanel
 
mouseClicked(MouseEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Optionally overridden by subclasses
mouseDragged(MouseEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Optionally overridden by subclasses
mouseEntered(MouseEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Optionally overridden by subclasses
mouseExited(MouseEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Called when the mouse exits the map panel.
mouseMoved(MouseEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Optionally overridden by subclasses
mousePressed(MouseEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Optionally overridden by subclasses
mouseReleased(MouseEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Optionally overridden by subclasses
move(int, boolean) - Method in class lejos.nxt.addon.LnrActrFirgelliNXT
Causes the actuator to move distance in encoder ticks.
move(int, boolean) - Method in interface lejos.robotics.LinearActuator
The actuator should retract (negative distance value) or extend (positive distance value) in encoder ticks distance.
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.
MOVE_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
MOVE_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
moveColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
called at start of a movement to inform the listeners that a movement has started
MoveProvider - Interface in lejos.robotics.navigation
Should be implemented by a Pilot that provides a partial movement to a pose when requested.
moves - Variable in class lejos.robotics.mapping.PCNavigationModel
 
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
moveStraight(float, int) - Method in class lejos.robotics.navigation.OmniPilot
This method causes the robot to move in a direction while keeping the front of the robot pointed in the current direction it is facing.
moveTo(Point) - Method in class lejos.geom.Point
Makes this a copy of the other point
moveTo(int, boolean) - Method in class lejos.nxt.addon.LnrActrFirgelliNXT
Causes the actuator to move to absolute position in encoder ticks.
moveTo(int, boolean) - Method in interface lejos.robotics.LinearActuator
The actuator should move to absolute position in encoder ticks.
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
multiplier - Variable in class lejos.nxt.addon.DIMUAccel
A factor to use when converting raw data from the accelerometer.
multiply(float) - Method in class lejos.geom.Point
Scalar multiplication
multiplyBy(float) - Method in class lejos.geom.Point
scalar multiplication
my_motor - Variable in class lejos.robotics.navigation.Ballbot
 

N

name - Variable in class lejos.pc.comm.NXTInfo
Friendly name of the NXT.
navEvent - Variable in class lejos.robotics.mapping.MenuAction
 
NavEventListener - Interface in lejos.robotics.mapping
 
NavigationListener - Interface in lejos.robotics.navigation
Interface for informing listeners that a way point has been reached.
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.
NavigationModel - Class in lejos.robotics.mapping
NavigationModel is an abstract class that has two implementations: NXTNavigationModel and PCNavigationModel.
NavigationModel() - Constructor for class lejos.robotics.mapping.NavigationModel
 
NavigationModel.NavEvent - Enum in lejos.robotics.mapping
Navigation events that are transmitted between the PC and the NXT (and vice versa).
NavigationPanel - Class in lejos.robotics.mapping
NavigationPanel is a JPanel that displays navigation data from PCNavigationModel, and allows the user to interact with it.
NavigationPanel() - Constructor for class lejos.robotics.mapping.NavigationPanel
 
Navigator - Class in lejos.robotics.navigation
This class controls a robot to traverse a Path, a sequence of Waypoints.
Navigator(MoveController) - Constructor for class lejos.robotics.navigation.Navigator
Allocates a Navigator object, using pilot that implements the ArcMoveController interface.
Navigator(MoveController, PoseProvider) - Constructor for class lejos.robotics.navigation.Navigator
Allocates a Navigator object using a pilot and a custom poseProvider, rather than the default OdometryPoseProvider.
NEIGHBOR_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
NEIGHBOR_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
neighbors() - Method in class lejos.robotics.pathfinding.Node
Indicates the number of neighbors (nodes connected to this node).
NO_ACTIVE_PROGRAM - Static variable in class lejos.nxt.remote.ErrorMessages
 
NO_DETECTION - Static variable in class lejos.nxt.addon.SumoEyesSensor
The Constant NO_DETECTION (0).
NO_FREE_MEMORY_IN_COMMUNICATION_BUFFER - Static variable in class lejos.nxt.remote.ErrorMessages
 
NO_LINEAR_SPACE - Static variable in class lejos.nxt.remote.ErrorMessages
 
NO_MORE_FILES - Static variable in class lejos.nxt.remote.ErrorMessages
 
NO_MORE_HANDLES - Static variable in class lejos.nxt.remote.ErrorMessages
 
NO_OF_SENSOR_TYPES - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NO_RELEASE - Static variable in interface lejos.nxt.I2CPort
Do not release the i2c bus between requests
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 class lejos.nxt.remote.ErrorMessages
 
NO_WRITE_BUFFERS - Static variable in class 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.
NODE_CIRC - Variable in class lejos.robotics.mapping.MapPanel
 
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.
nodes - Variable in class lejos.robotics.mapping.PCNavigationModel
 
NONE - Static variable in class lejos.robotics.Color
 
norm1() - Method in class lejos.util.Matrix
One norm
normalize() - Method in class lejos.geom.Point
Sets this vector's length to 1 unit while retaining direction
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 class lejos.nxt.remote.ErrorMessages
 
NOT_IMPLEMENTED - Static variable in class 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.
NullToolProgressMonitor - Class in js.common
Dummy progress listener.
NullToolProgressMonitor() - Constructor for class js.common.NullToolProgressMonitor
 
NUMBER_OF_SENSORS - Static variable in class lejos.nxt.addon.TouchMUX
number of touch sensors supported by this device
numFiles() - Method in class lejos.pc.tools.ExtendedFileModel
Return the number of files
numParticles() - Method in class lejos.robotics.localization.MCLParticleSet
Return the number of particles in the set
numParticlesField - Variable in class lejos.robotics.mapping.NavigationPanel
 
numParticlesLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
numReadings - Variable in class lejos.robotics.mapping.NavigationModel
 
NXJ_DEFRAG - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_DISCONNECT - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_GET_AUTO_RUN - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_GET_DEFAULT_PROGRAM - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_GET_KEY_CLICK_VOLUME - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_GET_SLEEP_TIME - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_GET_VERSION - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_GET_VOLUME - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_PACKET_MODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_SET_AUTO_RUN - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_SET_DEFAULT_PROGRAM - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_SET_KEY_CLICK_VOLUME - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_SET_SLEEP_TIME - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJ_SET_VOLUME - Static variable in interface lejos.nxt.remote.NXTProtocol
 
NXJBrowser - Class in lejos.pc.tools
Graphical file browser for leJOS NXJ.
NXJBrowser() - Constructor for class lejos.pc.tools.NXJBrowser
 
NXJChartingLogger - Class in lejos.pc.tools
 
NXJChartingLogger() - Constructor for class lejos.pc.tools.NXJChartingLogger
 
NXJConsole - Class in lejos.pc.tools
Console output monitor class.
NXJConsole() - Constructor for class lejos.pc.tools.NXJConsole
 
NXJConsoleViewer - Class in lejos.pc.tools
Downloads data from the RConsole running on a NXT.
Uses USB by default, or Bluetooth if selected from buttons.
NXJConsoleViewer(String) - Constructor for class lejos.pc.tools.NXJConsoleViewer
Constructor builds GUI
NXJControl - Class in lejos.pc.tools
Graphical control center for leJOS NXJ.
NXJControl() - Constructor for class lejos.pc.tools.NXJControl
 
NXJDataViewer - Class in lejos.pc.tools
Downloads data from the DataLogger running on a NXT
Uses Bluetooth or USB
To use BlueTooth, click "Use Bluetooth" before "Connect"
When the status is "Connected", click "Start Download"
If you want to resend, press any button except ESC on the NXT, then click "Start Download"
You can run another download session, but you have to connect again.
NXJDataViewer() - Constructor for class lejos.pc.tools.NXJDataViewer
Constructor builds GUI
NXJDebugTool - Class in lejos.pc.tools
 
NXJDebugTool() - Constructor for class lejos.pc.tools.NXJDebugTool
 
NXJFirmwareInfo - Class in lejos.nxt.remote
Information about leJOS NXJ firmware and menu
NXJFirmwareInfo() - Constructor for class lejos.nxt.remote.NXJFirmwareInfo
 
NXJFlash - Class in lejos.pc.tools
 
NXJFlash() - Constructor for class lejos.pc.tools.NXJFlash
 
NXJFlashG - Class in lejos.pc.tools
GUI application to write the leJOS Virtual Machine and Menu system to the NXT Flash.
NXJFlashG() - Constructor for class lejos.pc.tools.NXJFlashG
Creates new form NXJFlashG
NXJFlashUI - Interface in lejos.pc.tools
Interface to provide a notification UI mechanism for the flash update process.
NXJFlashUpdate - Class in lejos.pc.tools
Class to allow the updating and verification of the leJOS firmware.
NXJFlashUpdate(NXJFlashUI) - Constructor for class lejos.pc.tools.NXJFlashUpdate
 
NXJImage - Class in lejos.pc.tools
 
NXJImage() - Constructor for class lejos.pc.tools.NXJImage
 
NXJImageCodePanel - Class in lejos.pc.tools
 
NXJImageCodePanel() - Constructor for class lejos.pc.tools.NXJImageCodePanel
 
NXJImageConverter - Class in lejos.pc.tools
 
NXJImageConverter() - Constructor for class lejos.pc.tools.NXJImageConverter
 
NXJImageMainPanel - Class in lejos.pc.tools
 
NXJImageMainPanel() - Constructor for class lejos.pc.tools.NXJImageMainPanel
 
NXJImagePicturePanel - Class in lejos.pc.tools
 
NXJImagePicturePanel() - Constructor for class lejos.pc.tools.NXJImagePicturePanel
 
NXJLink - Class in lejos.pc.tools
Tiny VM.
NXJLink() - Constructor for class lejos.pc.tools.NXJLink
Constructor.
NXJLinkAndUpload - Class in lejos.pc.tools
Command-line utility that links and uploads NXJ programs in one call
NXJLinkAndUpload() - Constructor for class lejos.pc.tools.NXJLinkAndUpload
 
NXJLinkAndUploadCommandLineParser - Class in lejos.pc.tools
CommandLineParser
NXJLinkAndUploadCommandLineParser(Class<?>) - Constructor for class lejos.pc.tools.NXJLinkAndUploadCommandLineParser
 
NXJMapCommand - Class in lejos.pc.tools
MapCommand shows a mapped area and allow navigation commands to be sent to the NXT.
NXJMapCommand() - Constructor for class lejos.pc.tools.NXJMapCommand
 
NXJMonitor - Class in lejos.pc.tools
Monitors sensors and motors of NXT using LCP.
NXJMonitor() - Constructor for class lejos.pc.tools.NXJMonitor
 
NXJSocketProxy - Class in lejos.pc.tools
Socket Proxy for NXT Has two main functions.
NXJSocketProxy() - Constructor for class lejos.pc.tools.NXJSocketProxy
 
NXJUpload - Class in lejos.pc.tools
Command-line utility to upload a linked binary to the NXT.
NXJUpload() - Constructor for class lejos.pc.tools.NXJUpload
 
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(NXTCommRequest) - Constructor for class lejos.nxt.remote.NXTCommand
Create a NXTCommand object.
nxtCommand - Variable in class lejos.robotics.mapping.PCNavigationModel
 
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 NXTComm 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
 
NXTConnectionModel - Class in lejos.pc.tools
A table model for PC GUI programs.
NXTConnectionModel(NXTInfo[], int) - Constructor for class lejos.pc.tools.NXTConnectionModel
Create the model from an array of NXTInfo.
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
 
NXTFrame - Class in lejos.nxt
Graphical representation of the NXT on the PC, used for emulation of LCD and Button.
NXTFrame() - Constructor for class lejos.nxt.NXTFrame
Create the frame
nxtImageConvert(BufferedImage) - Static method in class lejos.pc.tools.NXJImageConverter
 
nxtImageData2Image(byte[], int, int) - Static method in class lejos.pc.tools.NXJImageConverter
 
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.
nxtLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
NXTMotor - Class in lejos.nxt
Abstraction for an NXT motor with no speed regulation.
NXTMotor(TachoMotorPort, int) - Constructor for class lejos.nxt.NXTMotor
Create an instance of a NXTMotor using the specified motor port and PWM operating mode.
NXTMotor(TachoMotorPort) - Constructor for class lejos.nxt.NXTMotor
Create an instance of a NXTMotor using the specified motor port the PWM operating mode will be PWM_BREAK BasicMotorPort.PWM_BRAKE
NXTname - Variable in class lejos.nxt.remote.DeviceInfo
 
nxtName - Variable in class lejos.robotics.mapping.NavigationModel
 
nxtName - Variable in class lejos.robotics.mapping.NavigationPanel
 
NXTNotFoundException - Exception in lejos.pc.tools
 
NXTNotFoundException() - Constructor for exception lejos.pc.tools.NXTNotFoundException
 
NXTNotFoundException(String) - Constructor for exception lejos.pc.tools.NXTNotFoundException
 
NXTNotFoundException(Throwable) - Constructor for exception lejos.pc.tools.NXTNotFoundException
 
NXTNotFoundException(String, Throwable) - Constructor for exception lejos.pc.tools.NXTNotFoundException
 
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

OBJ_HEADER - Static variable in class js.tinyvm.TinyVMConstants
 
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.
offset() - Method in class js.tinyvm.io.ByteWriter
Current offset in file.
offset() - Method in interface js.tinyvm.io.IByteWriter
 
offset - Variable in class lejos.nxt.addon.DIMUAccel
 
offset - Variable in class lejos.nxt.addon.DIMUGyro
 
OmniPilot - Class in lejos.robotics.navigation
Use the OmniPilot class to control holonomic vehicles with three omnidirectional wheels that allow the robot to move in any direction without changing heading.
OmniPilot(float, float, RegulatedMotor, RegulatedMotor, RegulatedMotor, boolean, boolean) - Constructor for class lejos.robotics.navigation.OmniPilot
Instantiates a new omnidirectional pilot.
OmniPilot(float, float, RegulatedMotor, RegulatedMotor, RegulatedMotor, boolean, boolean, SensorPort) - Constructor for class lejos.robotics.navigation.OmniPilot
Instantiates a new omnidirectional pilot.
ONE_ROTATION - Static variable in class lejos.nxt.addon.RCXRotationSensor
The incremental count for one whole rotation (360 degrees).
OP_AALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_AASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ACONST_NULL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ALOAD_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ALOAD_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ALOAD_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ALOAD_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ANEWARRAY - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ARETURN - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ARRAYLENGTH - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ASTORE_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ASTORE_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ASTORE_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ASTORE_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ATHROW - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_BALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_BASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_BIPUSH - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_BREAKPOINT - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_CALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_CASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_CHECKCAST - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_D2F - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_D2I - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_D2L - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DADD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DCMPG - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DCMPL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DCONST_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DCONST_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DDIV - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DLOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DLOAD_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DLOAD_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DLOAD_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DLOAD_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DMUL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DNEG - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DREM - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DRETURN - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DSTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DSTORE_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DSTORE_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DSTORE_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DSTORE_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DSUB - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DUP - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DUP2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DUP2_X1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DUP2_X2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DUP_X1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_DUP_X2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_F2D - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_F2I - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_F2L - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FADD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FCMPG - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FCMPL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FCONST_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FCONST_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FCONST_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FDIV - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FLOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FLOAD_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FLOAD_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FLOAD_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FLOAD_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FMUL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FNEG - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FREM - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FRETURN - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FSTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FSTORE_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FSTORE_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FSTORE_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FSTORE_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_FSUB - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_GETFIELD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_GETFIELD_1 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_GETSTATIC - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_GETSTATIC_1 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_GETSTATIC_2 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_GETSTATIC_3 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_GETSTATIC_4 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_GOTO - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_GOTO_W - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_I2B - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_I2C - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_I2D - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_I2F - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_I2L - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_I2S - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IADD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IAND - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ICONST_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ICONST_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ICONST_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ICONST_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ICONST_4 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ICONST_5 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ICONST_M1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IDIV - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IF_ACMPEQ - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IF_ACMPNE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IF_ICMPEQ - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IF_ICMPGE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IF_ICMPGT - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IF_ICMPLE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IF_ICMPLT - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IF_ICMPNE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IFEQ - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IFGE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IFGT - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IFLE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IFLT - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IFNE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IFNONNULL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IFNULL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IINC - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ILOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ILOAD_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ILOAD_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ILOAD_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ILOAD_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IMUL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_INEG - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_INSTANCEOF - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_INVOKEINTERFACE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_INVOKESPECIAL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_INVOKESTATIC - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_INVOKEVIRTUAL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IOR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IREM - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IRETURN - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ISHL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ISHR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ISTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ISTORE_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ISTORE_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ISTORE_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ISTORE_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_ISUB - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IUSHR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_IXOR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_JSR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_JSR_W - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_L2D - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_L2F - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_L2I - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LADD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LAND - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LCMP - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LCONST_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LCONST_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LDC - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LDC2_W - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LDC_1 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_LDC_2 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_LDC_3 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_LDC_4 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_LDC_W - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LDIV - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LLOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LLOAD_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LLOAD_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LLOAD_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LLOAD_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LMUL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LNEG - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LOOKUPSWITCH - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LOR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LREM - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LRETURN - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LSHL - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LSHR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LSTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LSTORE_0 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LSTORE_1 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LSTORE_2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LSTORE_3 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LSUB - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LUSHR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_LXOR - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_MONITORENTER - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_MONITOREXIT - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_MULTIANEWARRAY - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_NEW - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_NEWARRAY - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_NOP - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_POP - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_POP2 - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_PUTFIELD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_PUTFIELD_1 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_PUTSTATIC - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_PUTSTATIC_1 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_PUTSTATIC_2 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_PUTSTATIC_3 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_PUTSTATIC_4 - Static variable in interface js.tinyvm.OpCodeInfo
 
OP_RET - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_RETURN - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_SALOAD - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_SASTORE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_SIPUSH - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_SWAP - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_TABLESWITCH - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_WIDE - Static variable in interface js.tinyvm.OpCodeConstants
 
OP_XXXUNUSEDXXX - Static variable in interface js.tinyvm.OpCodeConstants
 
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_ARGS - Static variable in interface js.tinyvm.OpCodeInfo
 
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_NAME - Static variable in interface js.tinyvm.OpCodeInfo
 
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
 
OpCodeConstants - Interface in js.tinyvm
Machine-generated file.
OpCodeInfo - Interface in js.tinyvm
Machine-generated file.
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 name and address.
open(NXTInfo) - Method in interface lejos.pc.comm.NXTComm
Connect to a NXT found by a search or created from name 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 - Variable in class lejos.robotics.mapping.NavigationPanel
 
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(NavigationPanel, int, int, String, Color, JMenuBar) - Static method in class lejos.robotics.mapping.NavigationPanel
Create a frame to display the panel in
openInJFrame(NavigationPanel, int, int, String, Color) - Static method in class lejos.robotics.mapping.NavigationPanel
Version without a menu
openRead(String) - Method in class lejos.nxt.remote.NXTCommand
Opens a file on the NXT for reading.
openSambaDevice(int) - Method in class lejos.pc.tools.NXJFlashUpdate
Locate and open an nxt device in SAM-BA mode.
openWrite(String, int) - Method in class lejos.nxt.remote.NXTCommand
Opens a file on the NXT for writing.
operation(String) - Method in class js.common.NullToolProgressMonitor
 
operation(String) - Method in interface js.common.ToolProgressMonitor
Notification change of operation.
operation(String) - Method in class lejos.pc.tools.CLIToolProgressMonitor
 
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
 
options - Variable in class lejos.pc.tools.AbstractCommandLineParser
 
ORANGE - Static variable in class lejos.robotics.Color
 
out - Static variable in class lejos.pc.comm.SystemContext
Deprecated.  
OUT_OF_BOUNDARY - Static variable in class 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

p - Variable in class lejos.robotics.mapping.MenuAction
 
PACKET - Static variable in interface lejos.pc.comm.NXTComm
PACKET I/O mode.
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
 
paint(Graphics) - Method in class lejos.nxt.LCD
 
paint(Graphics) - Method in class lejos.pc.tools.Gauge
Paint the gauge.
paint(Graphics) - Method in class lejos.pc.tools.LCDDisplay
 
paintComponent(Graphics) - Method in class lejos.robotics.mapping.MapPanel
Overrides JPanel paintComponent to paint all the navigation data
paintComponent(Graphics) - Method in class lejos.robotics.mapping.NavigationPanel
 
paintFeatures(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
Paint features detected
paintGrid(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
Paint the grid
paintMap(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
Draw the map using Line2D objects
paintMesh(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
Paint the navigation mesh
paintMoves(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
Paint the moves made
paintParticles(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
Paint the particles
paintPath(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
Paint the path
paintPose(Graphics2D, Pose) - Method in class lejos.robotics.mapping.MapPanel
Paint the pose using Ellipse2D
paintRobot(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
If we are down to one small cluster show the location of the robot.
paintTarget(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
Paint the target
paintWaypoints(Graphics2D) - Method in class lejos.robotics.mapping.MapPanel
 
panel - Variable in class lejos.robotics.mapping.EventPanel
 
panel - Variable in class lejos.robotics.mapping.MenuAction
 
panel - Variable in class lejos.robotics.mapping.PCNavigationModel
 
param1 - Variable in class lejos.robotics.mapping.EventPanel
 
param2 - Variable in class lejos.robotics.mapping.EventPanel
 
param3 - Variable in class lejos.robotics.mapping.EventPanel
 
params - Variable in class lejos.pc.tools.AbstractCommandLineParser
 
parent - Variable in class lejos.robotics.mapping.MapPanel
 
parse(String[]) - Method in class lejos.pc.tools.NXJLinkAndUploadCommandLineParser
 
parseLogData(DataItem[]) - Static method in class lejos.pc.charting.LoggerProtocolManager
Parse an array of DataItems and return a formatted string suitable for logging
PARTICLE_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
PARTICLE_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
particleColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
particleField - Variable in class lejos.robotics.mapping.NavigationPanel
 
particlePanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
particleReadings - Variable in class lejos.robotics.mapping.PCNavigationModel
 
particles - Variable in class lejos.robotics.mapping.NavigationModel
 
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
path - Variable in class lejos.robotics.mapping.NavigationModel
 
Path - Class in lejos.robotics.pathfinding
Represents a path consisting of an ordered collection of waypoints
Path() - Constructor for class lejos.robotics.pathfinding.Path
 
PATH_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
PATH_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
pathColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
pathComplete(Waypoint, Pose, int) - Method in interface lejos.robotics.navigation.NavigationListener
Called when the robot has reached the last Waypoint of the path
pathCompleted() - Method in class lejos.robotics.navigation.Navigator
Returns true if the the final waypoint has been reached
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.
pathFinders - Variable in class lejos.robotics.mapping.NavigationPanel
 
pathGenerated() - Method in class lejos.robotics.navigation.Navigator
 
pathGenerated() - Method in interface lejos.robotics.navigation.WaypointListener
Called when generation of the path is complete
pathInterrupted(Waypoint, Pose, int) - Method in interface lejos.robotics.navigation.NavigationListener
called when the robot has stopped, not at a Waypoint
pause(int) - Static method in class lejos.nxt.Sound
 
PCNavigationModel - Class in lejos.robotics.mapping
The PCNavigationModel holds all the navigation data that is transmitted as events, to and from a NXT brick.
PCNavigationModel(MapApplicationUI) - Constructor for class lejos.robotics.mapping.PCNavigationModel
Create the model and associate the navigation panel with it
PCTFULLSCALEMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
PENDING_COMMUNICATION_TRANSACTION_IN_PROGRESS - Static variable in class lejos.nxt.remote.ErrorMessages
 
PERIODCOUNTERMODE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
PERSISTENT_FILENAME - Static variable in class lejos.util.PilotProps
 
pf - Variable in class lejos.robotics.mapping.PCNavigationModel
 
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
 
pfBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
pfLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
 
pilot - Variable in class lejos.robotics.mapping.NavigationPanel
 
pilotForm - Variable in class lejos.robotics.mapping.NavigationPanel
 
pilotOKButton - Variable in class lejos.robotics.mapping.NavigationPanel
 
PilotProps - Class in lejos.util
Configuration class for Differential Pilot.
PilotProps() - Constructor for class lejos.util.PilotProps
 
pilotTypeBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
pilotTypeLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
pilotTypes - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.robotics.mapping.NavigationPanel
 
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
returns a Point at location x,y
Point(float) - Constructor for class lejos.geom.Point
Returns a point ad distance 1 from the origin and an angle radans to the x-axis
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
 
popupMenu(MouseEvent) - Method in class lejos.robotics.mapping.NavigationPanel
Display a context menu at the specified point in the map panel.
popupMenuItems(Point, JPopupMenu) - Method in class lejos.pc.tools.NXJMapCommand
Add the required context menu items
popupMenuItems(Point, JPopupMenu) - Method in class lejos.robotics.mapping.NavigationPanel
Used by subclasses to add popup menu items
port - Variable in class lejos.nxt.addon.GyroSensor
The ADSensorPort passed in the constructor.
port - Variable in class lejos.nxt.addon.MagneticSensor
 
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.
poses - Variable in class lejos.robotics.mapping.PCNavigationModel
 
postProcessCode(RecordTable<CodeSequence>, JavaClass, Binary) - Method in class js.tinyvm.MethodRecord
 
postProcessCode(byte[], JavaClass, Binary) - Method in class js.tinyvm.MethodRecord
 
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
 
PressureDetector - Interface in lejos.robotics
Interface for pressure sensors.
PrimitiveClassRecord - Class in js.tinyvm
Abstraction for a class record (see vmsrc/language.h).
PrimitiveClassRecord() - Constructor for class js.tinyvm.PrimitiveClassRecord
 
print(PrintStream) - Method in class lejos.util.Matrix
 
printFooter(String, PrintWriter) - Method in class lejos.pc.tools.AbstractCommandLineParser
 
printHelp(OutputStream) - Method in class lejos.pc.tools.AbstractCommandLineParser
 
printHelp(PrintWriter) - Method in class lejos.pc.tools.AbstractCommandLineParser
 
printHelp(OutputStream, Throwable) - Method in class lejos.pc.tools.AbstractCommandLineParser
 
printHelp(PrintWriter, Throwable) - Method in class lejos.pc.tools.AbstractCommandLineParser
 
printInterfaces() - Method in class js.tinyvm.Binary
 
printReadings() - Method in class lejos.robotics.RangeReadings
Print the range readings on standard out
processArray(int) - Method in class js.tinyvm.CodeUtilities
Process and array index.
processCalls(byte[], JavaClass, Binary) - Method in class js.tinyvm.CodeUtilities
 
processClasses(String[], ClassPath) - Method in class js.tinyvm.Binary
 
processClassIndex(int) - Method in class js.tinyvm.CodeUtilities
Process a class index.
processCode(boolean) - Method in class js.tinyvm.Binary
 
processCode(byte[]) - Method in class js.tinyvm.CodeUtilities
 
processConstantIndex(int) - Method in class js.tinyvm.CodeUtilities
Process a constant index.
processConstants() - Method in class js.tinyvm.Binary
 
processedValue() - Method in class lejos.nxt.addon.EOPD
 
processFields() - Method in class js.tinyvm.Binary
 
processMethods() - Method in class js.tinyvm.Binary
Calls storeMethods on all the classes of the closure previously computed with processClasses.
processMultiArray(int) - Method in class js.tinyvm.CodeUtilities
 
processOptimizedClasses() - Method in class js.tinyvm.Binary
Optimize the number and order of classes.
processOptimizedConstants() - Method in class js.tinyvm.Binary
Store constant values in an optimal fashion.
processOptimizedFields() - Method in class js.tinyvm.Binary
 
processOptimizedMethods() - Method in class js.tinyvm.Binary
 
processSpecialSignatures() - Method in class js.tinyvm.Binary
 
program - Variable in class lejos.robotics.mapping.NavigationPanel
 
programCounterToLineNumberMap(int) - Method in class js.tinyvm.DebugData
returns a map with program counters with their associated line numbers
progress(int) - Method in class js.common.NullToolProgressMonitor
 
progress(int) - Method in interface js.common.ToolProgressMonitor
Notification about progress.
progress(int) - Method in class lejos.pc.tools.CLIToolProgressMonitor
 
progress(String, int) - Method in class lejos.pc.tools.NXJFlash
 
progress(String, int) - Method in interface lejos.pc.tools.NXJFlashUI
Report the progress of an ongoing operation.
projectOn(Line) - Method in class lejos.geom.Point
Finds the orthogonal projection of this point onto the line.
props - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
 
put(T, Object) - Method in class js.tinyvm.util.HashVector
Deprecated. method is to be removed since it doesn't seem to fit into the concept since there is no get method
PWM_BRAKE - Static variable in interface lejos.nxt.BasicMotorPort
PWM Mode.
PWM_FLOAT - Static variable in interface lejos.nxt.BasicMotorPort
PWM Mode.

Q

quickStop() - Method in class lejos.robotics.navigation.DifferentialPilot
Stops the robot almost immediately.
quit() - Method in class lejos.util.TextMenu
method to call from another thread to quit the menu

R

random - Variable in class lejos.robotics.mapping.NavigationPanel
 
random(int, int) - Static method in class lejos.util.Matrix
Generate matrix with random elements
randomForm - Variable in class lejos.robotics.mapping.NavigationPanel
 
randomMove - Variable in class lejos.robotics.mapping.NavigationPanel
 
randomMove() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a RANDOM_MOVE event to the NXT
randomOKButton - Variable in class lejos.robotics.mapping.NavigationPanel
 
randomPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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 - Variable in class lejos.nxt.addon.DIMUGyro
 
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.
RangeFeature(RangeReadings, Pose) - 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.
rateUnit - Variable in class lejos.nxt.addon.DIMUGyro
 
RAW - Static variable in interface lejos.pc.comm.NXTComm
RAW I/O mode.
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
 
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.
reached - Variable in class lejos.robotics.mapping.PCNavigationModel
 
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 class lejos.pc.charting.CachingInputStream
 
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.
readButtons() - Static method in class lejos.nxt.Button
 
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, byte[], int, 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.
readImage(BufferedImage) - Method in class lejos.pc.tools.NXJImageMainPanel
 
readings - Variable in class lejos.robotics.FixedRangeScanner
 
readings - Variable in class lejos.robotics.mapping.NavigationModel
 
readings - Variable in class lejos.robotics.RotatingRangeScanner
 
readingsField - Variable in class lejos.robotics.mapping.NavigationPanel
 
readingsPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
readLineMap() - Method in class lejos.robotics.mapping.ShapefileLoader
Retrieves a LineMap object from the Shapefile input stream.
readLineMap() - Method in class lejos.robotics.mapping.SVGMapLoader
 
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.
readNxtImage(File) - Method in class lejos.pc.tools.NXJImageMainPanel
 
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.MagneticSensor
Get the relative magnetic field strength
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
 
rebootDevice(NXTSamba) - Method in class lejos.pc.tools.NXJFlashUpdate
 
recalibrateOffset() - Method in class lejos.nxt.addon.CruizcoreGyro
 
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().
recalibrateOffsetAlt() - Method in class lejos.nxt.addon.GyroSensor
This function sets a suitable initial gyro offset.
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.
RecordTable<T extends WritableData> - Class in js.tinyvm
Record table.
RecordTable(String, boolean, boolean) - Constructor for class js.tinyvm.RecordTable
Constructor.
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
 
refresh() - Static method in class lejos.nxt.LCD
 
REG_ACCUMULATED_ANGLE - Static variable in class lejos.nxt.addon.AngleSensor
 
REG_ANGLE - Static variable in class lejos.nxt.addon.AngleSensor
 
REG_PRODUCT_ID - Static variable in class lejos.nxt.I2CSensor
Register number of sensor product ID, as defined by standard Lego I2C register layout.
REG_SPEED - Static variable in class lejos.nxt.addon.AngleSensor
 
REG_VENDOR_ID - Static variable in class lejos.nxt.I2CSensor
Register number of sensor vendor ID, as defined by standard Lego I2C register layout.
REG_VERSION - Static variable in class lejos.nxt.I2CSensor
Register number of sensor version string, as defined by standard Lego I2C register layout.
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.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
 
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
 
remove(Component) - Static method in class lejos.pc.tools.FileDrop
Removes the drag-and-drop hooks from the component and optionally from the all children.
remove(PrintStream, Component, boolean) - Static method in class lejos.pc.tools.FileDrop
Removes the drag-and-drop hooks from the component and optionally from the all children.
removeColor(BufferedImage, int) - Static method in class lejos.pc.tools.NXJImageConverter
 
removeListener() - Method in class lejos.nxt.addon.MMXRegulatedMotor
Remove the registered RegulatedMotorListener.
removeListener() - Method in class lejos.nxt.remote.RemoteMotor
 
removeListener() - Method in class lejos.robotics.MirrorMotor
 
removeListener() - Method in interface lejos.robotics.RegulatedMotor
Removes the RegulatedMotorListener from this class.
removeLoggerListener(LoggerListener) - Method in class lejos.pc.charting.LoggerProtocolManager
Remove a logger listener.
removeLogListener(NXTCommLogListener) - Method in class lejos.pc.comm.NXTCommLoggable
unregister log listener
removeLogListener(NXTCommLogListener) - Method in class lejos.pc.comm.NXTConnectionManager
unregister log listener
removeLogListener(ToolsLogListener) - Method in class lejos.pc.tools.NXJUpload
Unregister log listener
removeLogListener(ToolsLogListener) - Method in class lejos.pc.tools.Upload
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.
removeProgressMonitor(ToolProgressMonitor) - Method in class js.common.AbstractTool
deregister progress monitor
removeProgressMonitor(ToolProgressMonitor) - Method in class lejos.pc.tools.NXJLink
Unregister log listener
removeToolsLogListener(ToolsLogListener) - Method in class lejos.pc.tools.NXJLinkAndUpload
Unregister log listener
repaint() - Method in interface lejos.robotics.mapping.MapApplicationUI
Indicates that model data has changed that requires a repaint of the map panel
repaint - Variable in class lejos.robotics.mapping.NavigationPanel
 
REPLY_COMMAND - Static variable in interface lejos.nxt.remote.NXTProtocol
 
report(Writer) - Method in class js.tinyvm.BinaryReport
Create report.
REQUEST_FAILED - Static variable in class 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 - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.robotics.navigation.OmniPilot
Reset all tacho counts.
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.CompassHTSensor
Changes the current direction the compass is facing into the zero angle for the method getDegreesCartesian().
resetCartesianZero() - Method in class lejos.nxt.addon.CompassMindSensor
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.  
resetDevice(NXTInfo) - Method in class lejos.pc.tools.NXJFlashUpdate
Attempt to restart the nxt in SAM-BA mode.
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.LnrActrFirgelliNXT
Resets the tachometer (encoder) count to zero at the current actuator shaft position.
resetTachoCount() - Method in class lejos.nxt.addon.MMXMotor
Resets the tachometer count to zero.
resetTachoCount() - Method in class lejos.nxt.addon.MMXRegulatedMotor
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.NXTMotor
 
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.
resetTachoCount() - Method in interface lejos.robotics.LinearActuator
Reset the tachometer (encoder) count to zero at the current actuator position.
resetTachoCount() - Method in class lejos.robotics.MirrorMotor
 
resetTimeout() - Method in class lejos.util.TextMenu
Reset the timeout period.
result - Variable in class lejos.pc.tools.AbstractCommandLineParser
 
reverse() - Method in class lejos.geom.Point
same as multiply(-1);
reverseBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
reverseLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.
RIGHT - Static variable in class lejos.nxt.addon.SumoEyesSensor
The Constant RIGHT (3).
RIGHT - Static variable in class lejos.nxt.Button
The Right button.
rightMotorBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
rightMotorLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
rightOrth() - Method in class lejos.geom.Point
calculate the right handed cartesian orthogonal of this poiont
rightTachoField - Variable in class lejos.robotics.mapping.NavigationPanel
 
rightTachoLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
ROBOT_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
ROBOT_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
ROBOT_SIZE - Static variable in class lejos.robotics.mapping.MapPanel
 
robotColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
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, boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
rotate(int) - Method in class lejos.nxt.remote.RemoteMotor
 
rotate(float) - Method in class lejos.robotics.mapping.PCNavigationModel
Send a ROTATE event to the NXT
rotate(int) - Method in class lejos.robotics.MirrorMotor
 
rotate(int, boolean) - Method in class lejos.robotics.MirrorMotor
 
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 class lejos.robotics.navigation.OmniPilot
 
rotate(double, boolean) - Method in class lejos.robotics.navigation.OmniPilot
 
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.  
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.remote.RemoteMotor
 
rotateTo(int, boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
rotateTo(float) - Method in class lejos.robotics.mapping.PCNavigationModel
Send a ROTATE_TO event to the NXT
rotateTo(int) - Method in class lejos.robotics.MirrorMotor
 
rotateTo(int, boolean) - Method in class lejos.robotics.MirrorMotor
 
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(double) - Method in class lejos.robotics.navigation.Navigator
Rotates the robot to a new absolute heading.
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
RotatingRangeScanner(RegulatedMotor, RangeFinder, int) - Constructor for class lejos.robotics.RotatingRangeScanner
 
rotationCount - Variable in class lejos.nxt.remote.OutputState
 
rotationStarted(RegulatedMotor, int, boolean, long) - Method in class lejos.robotics.MirrorMotor
 
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.OmniPilot
 
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.MirrorMotor
 
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.OmniPilot
Notify the MoveListeners when a move is completed.
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(String[]) - Method in class lejos.pc.tools.NXJFlash
Run the flash command.
run(String[]) - Method in class lejos.pc.tools.NXJLink
Execute tiny vm.
run() - Method in class lejos.pc.tools.NXJMapCommand
 
run() - Method in class lejos.pc.tools.NXJMonitor
 
run() - Method in class lejos.robotics.navigation.Ballbot
 
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
 
runProgram(String) - Method in class lejos.pc.tools.NXJBrowser
 
runState - Variable in class lejos.nxt.remote.OutputState
 
RunTimeOptions - Enum in js.tinyvm
 

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
 
sampleRate - Variable in class lejos.nxt.addon.DIMUGyro
 
samples - Static variable in class lejos.nxt.addon.DIMUAccel
 
save(DebugData, OutputStream) - Static method in class js.tinyvm.DebugData
 
save(DebugData, File) - Static method in class js.tinyvm.DebugData
 
save() - Method in class lejos.nxt.addon.DIMUAccel
Saves the offset and scale factors in Flash memory.
save - Variable in class lejos.robotics.mapping.NavigationPanel
 
saveColors(Properties) - Method in class lejos.robotics.mapping.MapPanel
 
saveImage(File) - Method in class lejos.pc.tools.NXJImageMainPanel
 
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
saveProperties() - Method in class lejos.robotics.mapping.NavigationPanel
 
scale - Variable in class lejos.nxt.addon.DIMUAccel
 
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
 
scanLight(float, float, int, int) - Method in class lejos.robotics.LightScanner
Perform a scan for a number of light beacons within the arc defined by the start and end angles in the specified direction.
scanner - Variable in class lejos.robotics.mapping.NavigationPanel
 
scannerForm - Variable in class lejos.robotics.mapping.NavigationPanel
 
scannerOKButton - Variable in class lejos.robotics.mapping.NavigationPanel
 
scannerPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
search(String) - Method in interface lejos.pc.comm.NXTComm
Search for NXTs over USB, Bluetooth or both
search(String) - Method in class lejos.pc.comm.NXTCommBluecove
 
search(String) - Method in class lejos.pc.comm.NXTCommBluez
 
search(String) - 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 one or more NXTs and return an array of NXTInfo instances for those found.
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().
SEL_CHAR - Static variable in class lejos.util.TextMenu
identifies the currently selected item
select() - Method in class lejos.util.TextMenu
Allows the user to scroll through the items, using the right and left buttons (forward and back) The Enter key closes the menu
and returns the index of the selected item.
select(int) - Method in class lejos.util.TextMenu
Version of select without timeout
select(int, int) - Method in class lejos.util.TextMenu
Allows the user to scroll through the items, using the right and left buttons (forward and back) The Enter key closes the menu
and returns the index of the selected item.
sendButton - Variable in class lejos.robotics.mapping.EventPanel
 
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
 
sendExit() - Method in class lejos.robotics.mapping.PCNavigationModel
Send an EXITevent to the NXT
sendF7(int) - Method in class lejos.nxt.addon.RCXLink
 
sendMap() - Method in class lejos.robotics.mapping.PCNavigationModel
Send the map to the NXT
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.
sendRandomMoveParams(float, float) - Method in class lejos.robotics.mapping.PCNavigationModel
Send Random Move parameters to the NXT
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.
sendSound(int) - Method in class lejos.robotics.mapping.PCNavigationModel
Send a system sound
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
SensorPanel - Class in lejos.pc.tools
JPanel that displays two gauges: one for the raw and one for the scaled value of a NXT sensor.
SensorPanel(String) - Constructor for class lejos.pc.tools.SensorPanel
Create the panel
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
 
Servo - Interface in lejos.robotics
Abstraction for a range-limited servo motor.
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.MirrorMotor
 
setAcceleration(int) - Method in class lejos.robotics.navigation.DifferentialPilot
Sets the normal acceleration of the robot in distance/second/second where distance is in the units of wheel diameter.
setAcceleration(int) - Method in class lejos.robotics.navigation.OmniPilot
Sets the acceleration.
setAcceleration(int) - Method in interface lejos.robotics.RegulatedMotor
Set the required rate of acceleration degrees/s/s
setAccelUnit(DIMUAccel.AccelUnits) - Method in class lejos.nxt.addon.DIMUAccel
Sets the unit for acceleration
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.
setAngle(float) - Method in interface lejos.robotics.Servo
Sets the rotational position (angle) of a ranged 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
 
setAutoRefresh(boolean) - Static method in class lejos.nxt.LCD
 
setAutoRun(boolean) - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to set auto-run on or off
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
 
setBytes(byte[]) - Method in class js.tinyvm.CodeSequence
 
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.
setClearance(float) - Method in class lejos.robotics.pathfinding.RandomPathFinder
Set the clearance around the edge of the map.
setCode(String) - Method in class lejos.pc.tools.NXJImageCodePanel
 
setCommentsVisible(boolean) - Method in class lejos.pc.charting.CustomChartPanel
Control the visibility of any comment markers defined for the chart.
setConnected(boolean) - Method in class lejos.pc.tools.DataViewComms
 
setConnected(int, NXTConnectionState) - Method in class lejos.pc.tools.NXTConnectionModel
 
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.
setData(NXTInfo[], int) - Method in class lejos.pc.tools.NXTConnectionModel
Update the data in the model.
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) - Static 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
setDebug(boolean) - Method in class lejos.robotics.mapping.NavigationModel
Set debug output on of off
setDebug(boolean) - Method in class lejos.robotics.pathfinding.ShortestPathFinder
 
setDefaultProgram(String) - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to set the default program
setDefaults() - Method in class lejos.robotics.mapping.MapPanel
 
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
 
setDelay(int) - Method in class lejos.util.DebugMessages
Set the delay measured in MS.
setDelayEnabled(boolean) - Method in class lejos.util.DebugMessages
Enable/Disabled if you need to show output with delay
setDescription(String) - Method in class lejos.robotics.mapping.NavigationPanel
Set the description used in the About popup
setDifferentialPilotParams(float, float, int, int, boolean) - Method in class lejos.robotics.mapping.PCNavigationModel
Set the parameters for a DifferentialPilot, send them to the NXT, and write them to the pilot.props file.
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.
setDomainScale(int) - Method in class lejos.pc.charting.CustomChartPanel
Set the width of the x-axis (domain) scale centered around current midpoint of domain scale.
setDynamicOffset(boolean[]) - Method in class lejos.nxt.addon.DIMUGyro
Enables or disables the dynamic offset correction mechanism of the sensor Dynamic offset correction assumes that in the long run the sensor keeps its orientation.
setEditEnable(boolean) - Method in class lejos.pc.tools.NXJImageCodePanel
 
setErr(Writer) - Static method in class lejos.pc.comm.SystemContext
Deprecated.  
setFile(File) - Method in class lejos.pc.tools.NXJImageMainPanel
 
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.
setGearRatio(int) - Method in class lejos.robotics.RotatingRangeScanner
Set the gear ratio
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
 
setHeadMotor(RegulatedMotor) - Method in class lejos.robotics.RotatingRangeScanner
Set the head motor
setHiddenBy(MethodRecord) - Method in class js.tinyvm.MethodRecord
 
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
 
setImage(BufferedImage) - Method in class lejos.pc.tools.NXJImagePicturePanel
 
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.
setItems(String[]) - Method in class lejos.util.TextMenu
set the array of items to be displayed
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
setKeyClickVolume(byte) - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to set the key click volume level
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
setLCDLines(int) - Method in class lejos.util.DebugMessages
Set the number of lines to show in the screen.
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
setLongRange(boolean) - Method in class lejos.nxt.addon.SumoEyesSensor
Enables long range of the sensor.
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(RangeMap) - Method in class lejos.robotics.localization.MCLPoseProvider
Associates a map with the MCLPoseProvider (for example a map send from the PC).
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
 
setMapOrigin(Point) - Method in class lejos.robotics.mapping.NavigationPanel
 
setMapPanelSize(Dimension) - Method in class lejos.robotics.mapping.NavigationPanel
Set the size of the map panel
setMapSize(Dimension) - Method in class lejos.robotics.mapping.NavigationPanel
Set the size of the map panel
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.
setMaxDistance(float) - Method in class lejos.robotics.pathfinding.RandomPathFinder
Set the maximum distance between waypoints
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
setMaxIterations(int) - Method in class lejos.robotics.pathfinding.RandomPathFinder
Set the maximum number of iterations before giving up when searching for a path
setMaxPositionError(double) - Method in class lejos.robotics.navigation.Waypoint
 
setMaxRange(float) - Method in class lejos.robotics.pathfinding.RandomPathFinder
Set the maximum valid range readings
setMaxVal(int) - Method in class lejos.pc.tools.Gauge
Set the maximum value for the gauge
setMaxVal(int) - Method in class lejos.pc.tools.LabeledGauge
Set the maximum value
setMaxValue(int) - Method in class lejos.robotics.mapping.SliderPanel
 
setMCL(MCLPoseProvider) - Method in class lejos.robotics.mapping.PCNavigationModel
Set an MCLPOseProvider for this model
setMeshParams(int, int) - Method in class lejos.robotics.mapping.PCNavigationModel
Set the parameter for the 4-way mesh
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.OmniPilot
 
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
 
setMoveDirection(int) - Method in class lejos.robotics.navigation.OmniPilot
Sets the move direction.
setMoveSpeed(float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
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.
setNumReadings(int) - Method in class lejos.robotics.mapping.NavigationModel
Set the number of readings for MCL
setNxjHome(String) - Static method in class lejos.pc.comm.SystemContext
Deprecated.  
setNXTCommand(NXTCommand) - Static method in class lejos.pc.comm.NXTCommandConnector
 
setOffset(int) - Method in class lejos.nxt.addon.GyroSensor
Set the offset used by readValue().
setOffsetCorrectionSpeed(float) - Method in class lejos.nxt.addon.DIMUGyro
 
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
 
setParticles(MCLParticleSet) - Method in class lejos.robotics.localization.MCLPoseProvider
Associate a particle set with the MCLPoseProvider (e.g.
setParticleSet(MCLParticleSet) - Method in class lejos.robotics.mapping.NavigationModel
Set the MCL Particle set
setPath(Path) - Method in class lejos.robotics.navigation.Navigator
Sets the path that the Navigator will traverse.
setPathFinder(int) - Method in class lejos.robotics.mapping.PCNavigationModel
 
setPixel(int, int, int) - Static method in class lejos.nxt.LCD
 
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
set the initial pose cloud with radius noise 1 and heading noise 1
setPose(Pose) - Method in class lejos.robotics.localization.OdometryPoseProvider
 
setPose(Pose) - Method in interface lejos.robotics.localization.PoseProvider
 
setPose(Pose) - Method in class lejos.robotics.mapping.PCNavigationModel
Send a SET_POSE event to the NXT
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.Navigator
Sets the PoseProvider after construction of the Navigator
setPoseProvider(PoseProvider) - Method in class lejos.robotics.objectdetection.RangeFeatureDetector
 
setPosition(float, float, float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
setPower(int) - Method in class lejos.nxt.addon.LnrActrFirgelliNXT
Sets the power for the actuator.
setPower(int) - Method in class lejos.nxt.addon.MMXMotor
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
setPower(int) - Method in interface lejos.robotics.LinearActuator
Set the power level 0%-100% to be applied to the actuator motor where 0% is no movement and 100% is full speed.
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.
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.
setpulseWidth(int) - Method in interface lejos.robotics.Servo
Set the PWM pulse width for the 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(DIMUGyro.Range) - Method in class lejos.nxt.addon.DIMUGyro
 
setRange(int, float, float) - Method in class lejos.robotics.RangeReadings
Set the range reading
setRange(int, int, int) - Method in interface lejos.robotics.Servo
Set the allowable pulse width operating range of this servo in microseconds and the total travel range to allow the use of angle-based parameters to control the servo.
setRangeFeatureParams(float, int) - Method in class lejos.robotics.mapping.PCNavigationModel
Set the parameter for a Range Feature Detector
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
setRateUnit(DIMUGyro.RateUnits) - Method in class lejos.nxt.addon.DIMUGyro
 
setRawMaxVal(int) - Method in class lejos.pc.tools.SensorPanel
Set the maximum raw value
setRawMode() - Method in class lejos.nxt.addon.RCXLink
 
setRawVal(int) - Method in class lejos.pc.tools.SensorPanel
Set the raw value of the sensor
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.
setRobotPose(Pose) - Method in class lejos.robotics.mapping.NavigationModel
Set the current robot pose
setRotateSpeed(float) - Method in class lejos.robotics.mapping.PCNavigationModel
Set the rotate speed for a pilot
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 class lejos.robotics.navigation.OmniPilot
 
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.
setRotatingRangeScannerParams(int, int) - Method in class lejos.robotics.mapping.PCNavigationModel
Set the patameters for a Rotating Range Scanner
setRunTimeOptions(int) - Method in class js.tinyvm.Binary
 
setRunTimeOptions(int) - Method in class js.tinyvm.MasterRecord
 
setSampleRate(DIMUGyro.SampleRate) - Method in class lejos.nxt.addon.DIMUGyro
 
setScaledMaxVal(int) - Method in class lejos.pc.tools.SensorPanel
Set the maximum scaled value for the sensor
setScaledVal(int) - Method in class lejos.pc.tools.SensorPanel
Set the scaled value of the sensor
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.
setSeries(String[]) - Method in class lejos.pc.charting.CustomChartPanel
Set the passed series/header definitions as new XYseries in the dataset.
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
setSleepTime(byte) - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to the the sleep time for the menu
setSourceDistance(float) - Method in class lejos.robotics.pathfinding.DijkstraPathFinder.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.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.LightScanner
 
setSpeed(int) - Method in class lejos.robotics.MirrorMotor
 
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 class lejos.robotics.navigation.OmniPilot
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.
setStallThreshold(int, int) - Method in class lejos.nxt.addon.MMXRegulatedMotor
Not implemented in the NXTMMX.
setStallThreshold(int, int) - Method in class lejos.nxt.remote.RemoteMotor
 
setStallThreshold(int, int) - Method in class lejos.robotics.MirrorMotor
 
setStallThreshold(int, int) - Method in interface lejos.robotics.RegulatedMotor
Set the parameters for detecting a stalled motor.
setState(Matrix, Matrix) - Method in class lejos.util.KalmanFilter
 
setStatus(String) - Method in class lejos.pc.tools.ConsoleViewerSwingUI
Messages generated by ConsoleViewComms show in the status Field
setStatus(String) - Method in interface lejos.pc.tools.ConsoleViewerUI
 
setStatus(String) - Method in interface lejos.pc.tools.DataViewerUI
 
setStatus(String) - Method in class lejos.pc.tools.NXJConsole
 
setStatus(String) - Method in class lejos.pc.tools.NXJConsoleViewer
Messages generated by ConsoleViewComms show in the status Field
setStatus(String) - Method in class lejos.pc.tools.NXJControl
Used by console viewer
setStatus(String) - Method in class lejos.pc.tools.NXJDataViewer
Messages generated show in the status Field
setTarget(Waypoint) - Method in class lejos.robotics.mapping.NavigationModel
Set the target waypoint that the robot is to go to
setTarget(Waypoint) - Method in class lejos.robotics.mapping.PCNavigationModel
Set the target for a path finder
setTemperatureUnit(DIMUGyro.TemperatureUnits) - Method in class lejos.nxt.addon.DIMUGyro
 
setThreshold(int) - Method in class lejos.pc.tools.NXJImagePicturePanel
 
setTiltUnit(DIMUAccel.TiltUnits) - Method in class lejos.nxt.addon.DIMUAccel
Sets the unit for tilt
setTime(int, int, int) - Method in interface lejos.robotics.Clock
 
setTimeOut(int) - Method in class lejos.nxt.rcxcomm.RCXAbstractPort
Setter for property timeOut.
setTitle(String) - Method in class lejos.robotics.mapping.NavigationPanel
Set the title use for the frame and the About popup
setTitle(String) - Method in class lejos.util.TextMenu
set menu title.
setTrackingMode(char) - Method in class lejos.nxt.addon.NXTCam
Choose either object or line tracking mode.
setTravelSpeed(float) - Method in class lejos.robotics.mapping.PCNavigationModel
Set the travel speed for the pilot.
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.OmniPilot
 
setTravelSpeed(double) - Method in class lejos.robotics.navigation.SteeringPilot
 
setTurnSpeed(float) - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
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
 
setType(String) - Method in class lejos.pc.tools.SensorPanel
Set the type of the sensor
setTypeAndMode(int, int) - Method in interface lejos.nxt.BasicSensorPort
 
setTypeAndMode(int, int) - Method in class lejos.nxt.SensorPort
 
setVal(int) - Method in class lejos.pc.tools.Gauge
Set the value to display
setVal(int) - Method in class lejos.pc.tools.LabeledGauge
Set the value
setValue(int) - Method in class lejos.robotics.mapping.SliderPanel
 
setValueAt(Object, int, int) - Method in class lejos.pc.tools.ExtendedFileModel
Set the value of a cell
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
setVerbose(boolean) - Method in class js.common.NullToolProgressMonitor
 
setVerbose(boolean) - Method in interface js.common.ToolProgressMonitor
Be verbose?
setVerbose(boolean) - Method in class lejos.pc.tools.CLIToolProgressMonitor
Be verbose?
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.
setVolume(byte) - Method in class lejos.nxt.remote.NXTCommand
leJOS-specific command to set the master volume level
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
 
showColors() - Method in class lejos.robotics.mapping.MapPanel
 
showCommandPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showConnectPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showControlPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showEventPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showGrid - Variable in class lejos.robotics.mapping.NavigationPanel
 
showLastMovePanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showLoadMapPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showLog - Variable in class lejos.robotics.mapping.NavigationPanel
 
showMesh - Variable in class lejos.robotics.mapping.NavigationPanel
 
showMessage(String) - Method in interface lejos.pc.tools.DataViewerUI
 
showMessage(String) - Method in class lejos.pc.tools.NXJBrowser
 
showMessage(String) - Method in class lejos.pc.tools.NXJControl
Show a pop-up message
showMessage(String) - Method in class lejos.pc.tools.NXJDataViewer
Show message in dialog box
showMessage(String) - Method in class lejos.pc.tools.NXJMonitor
 
showMoves - Variable in class lejos.robotics.mapping.NavigationPanel
 
showParticlePanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showParticles - Variable in class lejos.robotics.mapping.NavigationPanel
 
showReadingsPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showStatusPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
showZoomLabels - Variable in class lejos.robotics.mapping.NavigationPanel
 
shutDown() - Method in class lejos.robotics.mapping.PCNavigationModel
Shut down the receiver thread
signalStrength - Variable in class lejos.nxt.remote.DeviceInfo
 
signature() - Method in class js.tinyvm.ClassRecord
 
Signature - Class in js.tinyvm
 
Signature(String, String) - Constructor for class js.tinyvm.Signature
 
Signature(String) - Constructor for class js.tinyvm.Signature
 
signature() - Method in class js.tinyvm.TinyVMType
 
SIGNATURES - Static variable in class js.tinyvm.SpecialConstants
 
singleStep(boolean) - Method in class lejos.robotics.navigation.Navigator
Controls whether the robot stops at each Waypoint; applies to the current path only.
size() - Method in class js.tinyvm.RecordTable
Number of entries.
size() - Method in class js.tinyvm.TinyVMType
Get type size in bytes.
size() - Method in class js.tinyvm.util.HashVector
 
SIZE - Static variable in class lejos.nxt.addon.NXTCam
Used by sortBy() to choose sorting criteria based on size (ordered largest to smallest).
size - Variable in class lejos.robotics.mapping.MapPanel
 
sleep() - Method in class lejos.nxt.addon.NXTLineLeader
Sleep the sensor
slider - Variable in class lejos.robotics.mapping.SliderPanel
 
sliderLabelText - Variable in class lejos.robotics.mapping.SliderPanel
 
SliderPanel - Class in lejos.robotics.mapping
 
SliderPanel(PCNavigationModel, NavigationModel.NavEvent, String, String, int) - Constructor for class lejos.robotics.mapping.SliderPanel
 
SLOPEMASK - Static variable in interface lejos.nxt.remote.NXTProtocol
 
smoothAcceleration(boolean) - Method in class lejos.nxt.remote.RemoteMotor
 
SocketProxy - Class in lejos.pc.tools
Deprecated. use lejos.pc.tools.NXJLink instead
SocketProxy() - Constructor for class lejos.pc.tools.SocketProxy
Deprecated.  
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.
SpecialConstants - Class in js.tinyvm
 
SpecialConstants() - Constructor for class js.tinyvm.SpecialConstants
 
SPECIFIED_CHANNEL_CONNECTION_IS_NOT_VALID - Static variable in class lejos.nxt.remote.ErrorMessages
Specified channel/connection is not valid
SPECIFIED_CHANNEL_CONNECTION_NOT_CONFIGURED_OR_BUSY - Static variable in class lejos.nxt.remote.ErrorMessages
Specified channel/connection not configured or busy
SPECIFIED_MAILBOX_QUEUE_IS_EMPTY - Static variable in class lejos.nxt.remote.ErrorMessages
 
SPI_PORT - Variable in class lejos.nxt.addon.LMotor
 
spinningMove(float, int, int) - Method in class lejos.robotics.navigation.OmniPilot
Causes the robot to spin while moving along a linear path.
stalled() - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated.  
STANDARD_MODE - Static variable in interface lejos.nxt.I2CPort
 
start(String[]) - Static method in class lejos.pc.tools.NXJBrowser
 
start(String[]) - Static method in class lejos.pc.tools.NXJChartingLogger
 
start(String[]) - Static method in class lejos.pc.tools.NXJConsole
 
start(String[]) - Static method in class lejos.pc.tools.NXJConsoleViewer
 
start(String[]) - Static method in class lejos.pc.tools.NXJControl
 
start(String[]) - Static method in class lejos.pc.tools.NXJDataViewer
 
start(String[]) - Static method in class lejos.pc.tools.NXJDebugTool
 
start(String[]) - Static method in class lejos.pc.tools.NXJFlash
 
start(String[]) - Static method in class lejos.pc.tools.NXJFlashG
 
start(String[]) - Static method in class lejos.pc.tools.NXJImage
 
start(String[]) - Static method in class lejos.pc.tools.NXJLink
 
start(String[]) - Static method in class lejos.pc.tools.NXJLinkAndUpload
 
start(String[]) - Static method in class lejos.pc.tools.NXJMapCommand
 
start(String[]) - Static method in class lejos.pc.tools.NXJMonitor
 
start(String[]) - Static method in class lejos.pc.tools.NXJSocketProxy
 
start(String[]) - Static method in class lejos.pc.tools.NXJUpload
 
start - Variable in class lejos.robotics.mapping.PCNavigationModel
 
start() - Method in class lejos.robotics.subsumption.Arbitrator
This method starts the arbitration of Behaviors and runs an endless loop.
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.CompassHTSensor
Starts calibration for the compass.
startCalibration() - Method in class lejos.nxt.addon.CompassMindSensor
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.
startDownload() - Method in class lejos.pc.tools.DataViewComms
 
startDrag - Variable in class lejos.robotics.mapping.NavigationPanel
 
startFirmware() - Method in class lejos.nxt.addon.RFIDSensor
Start the firmware on the RFID device.
startListen() - Method in class lejos.pc.charting.LoggerProtocolManager
Start listening for and processing logging data.
startMotor(int) - Method in class lejos.nxt.addon.RCXLink
 
startMotors() - Method in class lejos.nxt.addon.NXTMMX
Starts both motors at the same time.
startNavigator() - Method in class lejos.robotics.mapping.PCNavigationModel
Start the navigator following a path
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.
stateChanged(ChangeEvent) - Method in class lejos.pc.charting.CustomChartPanel
 
stateChanged(ChangeEvent) - Method in class lejos.pc.tools.NXJConsoleViewer
Update the status field when USB or Bluetooth radio buttons selected
stateChanged(ChangeEvent) - Method in class lejos.pc.tools.NXJDataViewer
Called when USB/Bluetooth radio buttons are selected or changed
stateChanged(ChangeEvent) - Method in class lejos.robotics.mapping.SliderPanel
 
StaticFieldRecord - Class in js.tinyvm
 
StaticFieldRecord(Field, ClassRecord) - Constructor for class js.tinyvm.StaticFieldRecord
 
StaticValue - Class in js.tinyvm
 
StaticValue(Field) - Constructor for class js.tinyvm.StaticValue
 
status - Variable in class lejos.nxt.remote.DeviceInfo
 
status - Variable in class lejos.nxt.remote.FirmwareInfo
 
status - Variable in class lejos.nxt.remote.OutputState
 
statusPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.  
steer(float) - Method in class lejos.robotics.navigation.OmniPilot
Steer.
steer(float, float) - Method in class lejos.robotics.navigation.OmniPilot
Steer.
steer(float, float, boolean) - Method in class lejos.robotics.navigation.OmniPilot
Steer.
steerBackward(double) - Method in class lejos.robotics.navigation.DifferentialPilot
Starts the robot moving backward along a curved path.
steeringMotorBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
steeringMotorLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
steeringPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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, RegulatedMotor, double, int, int) - Constructor for class lejos.robotics.navigation.SteeringPilot
Creates an instance of the SteeringPilot.
steerPrep(float) - Method in class lejos.robotics.navigation.LegacyPilot
Deprecated. helper method used by steer(float) and steer(float,float,boolean)
steerWheelDiameterField - Variable in class lejos.robotics.mapping.NavigationPanel
 
steerWheelDiameterLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
stop() - Method in class lejos.nxt.addon.LnrActrFirgelliNXT
Immediately stop any current actuator action.
stop() - Method in class lejos.nxt.addon.MMXMotor
Causes motor to stop pretty much instantaneously.
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.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 interface lejos.robotics.LinearActuator
Cause the actuator to stop immediately and resist any further motion.
stop - Variable in class lejos.robotics.mapping.NavigationPanel
 
stop() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a STOP event to the NXT
stop(boolean) - Method in class lejos.robotics.MirrorMotor
 
stop() - Method in class lejos.robotics.MirrorMotor
 
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.Navigator
Stops the robot.
stop() - Method in class lejos.robotics.navigation.OmniPilot
 
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
 
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.CompassHTSensor
Ends calibration sequence.
stopCalibration() - Method in class lejos.nxt.addon.CompassMindSensor
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
 
storeCode(RecordTable<CodeSequence>, boolean) - Method in class js.tinyvm.ClassRecord
 
storeCode(RecordTable<CodeSequence>, boolean) - Method in class js.tinyvm.PrimitiveClassRecord
 
storeComponents() - Method in class js.tinyvm.Binary
 
storeConstants(RecordTable<ConstantRecord>, RecordTable<ConstantValue>) - Method in class js.tinyvm.ClassRecord
 
storeConstants(RecordTable<ConstantRecord>, RecordTable<ConstantValue>) - Method in class js.tinyvm.PrimitiveClassRecord
 
storeExceptionTable(CodeException[], Binary, JavaClass) - Method in class js.tinyvm.MethodRecord
 
storeFields(RecordTable<RecordTable<InstanceFieldRecord>>, RecordTable<StaticFieldRecord>, RecordTable<StaticValue>) - Method in class js.tinyvm.ClassRecord
 
storeFields(RecordTable<RecordTable<InstanceFieldRecord>>, RecordTable<StaticFieldRecord>, RecordTable<StaticValue>) - Method in class js.tinyvm.PrimitiveClassRecord
 
storeInterfaceMap(RecordTable<InterfaceMap>) - Method in class js.tinyvm.ClassRecord
Create and store the inetrface map for this interface class.
storeMethods(RecordTable<RecordTable<MethodRecord>>, RecordTable<RecordTable<ExceptionRecord>>, HashVector<Signature>, boolean) - Method in class js.tinyvm.ClassRecord
 
storeMethods(RecordTable<RecordTable<MethodRecord>>, RecordTable<RecordTable<ExceptionRecord>>, HashVector<Signature>, boolean) - Method in class js.tinyvm.PrimitiveClassRecord
 
storeOptimizedFields(RecordTable<RecordTable<InstanceFieldRecord>>) - Method in class js.tinyvm.ClassRecord
 
storeOptimizedFields(RecordTable<RecordTable<InstanceFieldRecord>>) - Method in class js.tinyvm.PrimitiveClassRecord
 
storeOptimizedImplementingClasses(RecordTable<ClassRecord>) - Method in class js.tinyvm.ClassRecord
Add the classes which implement this interface into the the set of class records.
storeOptimizedMethods(RecordTable<RecordTable<MethodRecord>>, RecordTable<RecordTable<ExceptionRecord>>, HashVector<Signature>) - Method in class js.tinyvm.ClassRecord
 
storeOptimizedMethods(RecordTable<RecordTable<MethodRecord>>, RecordTable<RecordTable<ExceptionRecord>>, HashVector<Signature>) - Method in class js.tinyvm.PrimitiveClassRecord
 
storeOptimizedStaticFields(RecordTable<StaticFieldRecord>, RecordTable<StaticValue>, int) - Method in class js.tinyvm.ClassRecord
 
storeOptimizedStaticFields(RecordTable<StaticFieldRecord>, RecordTable<StaticValue>, int) - Method in class js.tinyvm.PrimitiveClassRecord
 
storePersistentValues() - Method in class lejos.util.PilotProps
 
storeReferredClasses(HashMap<String, ClassRecord>, RecordTable<ClassRecord>, ClassPath, ArrayList<String>) - Method in class js.tinyvm.ClassRecord
 
storeReferredClasses(HashMap<String, ClassRecord>, RecordTable<ClassRecord>, ClassPath, ArrayList<String>) - Method in class js.tinyvm.PrimitiveClassRecord
 
stripColons(String) - Method in class lejos.pc.comm.NXTCommBluecove
 
subtract(Point) - Method in class lejos.geom.Point
Vector subtraction
subtract(float) - Method in class lejos.geom.Point
Vector subtraction
subtractWith(Point) - Method in class lejos.geom.Point
vector subtraction
SUCCESS - Static variable in class lejos.nxt.remote.ErrorMessages
 
SumoEyesSensor - Class in lejos.nxt.addon
Java class for MINDSENSORS NXT SumoEyes (triple zone IR obstacle detector).
SumoEyesSensor(ADSensorPort) - Constructor for class lejos.nxt.addon.SumoEyesSensor
Default constructor.
SumoEyesSensor(ADSensorPort, boolean) - Constructor for class lejos.nxt.addon.SumoEyesSensor
Constructor with range specification.
suppress() - Method in interface lejos.robotics.subsumption.Behavior
The code in suppress() should cause the current behavior to exit.
SVGMapLoader - Class in lejos.robotics.mapping
This class loads map data from an SVG and produces a LineMap object, which can be used by the leJOS navigation package.
SVGMapLoader(InputStream) - Constructor for class lejos.robotics.mapping.SVGMapLoader
 
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.  
systemSound(boolean, int) - Static method in class lejos.nxt.Sound
Play a system sound.

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
T_ARRAY - Static variable in class js.tinyvm.TinyVMType
 
T_ARRAY_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_BOOLEAN - Static variable in class js.tinyvm.TinyVMType
 
T_BOOLEAN_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_BYTE - Static variable in class js.tinyvm.TinyVMType
 
T_BYTE_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_CHAR - Static variable in class js.tinyvm.TinyVMType
 
T_CHAR_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_CLASS - Static variable in class js.tinyvm.TinyVMType
 
T_CLASS_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_DOUBLE - Static variable in class js.tinyvm.TinyVMType
 
T_DOUBLE_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_FLOAT - Static variable in class js.tinyvm.TinyVMType
 
T_FLOAT_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_INT - Static variable in class js.tinyvm.TinyVMType
 
T_INT_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_LONG - Static variable in class js.tinyvm.TinyVMType
 
T_LONG_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_OBJECT - Static variable in class js.tinyvm.TinyVMType
 
T_OBJECT_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_REFERENCE - Static variable in class js.tinyvm.TinyVMType
 
T_REFERENCE_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_SHORT - Static variable in class js.tinyvm.TinyVMType
 
T_SHORT_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_STACKFRAME_TYPE - Static variable in class js.tinyvm.TinyVMType
 
T_VOID - Static variable in class js.tinyvm.TinyVMType
 
T_VOID_TYPE - Static variable in class js.tinyvm.TinyVMType
 
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.
takeControl() - Method in interface lejos.robotics.subsumption.Behavior
The boolean return indicates if this behavior should seize control of the robot.
takeReadings() - Method in class lejos.robotics.mapping.PCNavigationModel
Send a TAKE_READINGS event to the NXT
target - Variable in class lejos.robotics.mapping.NavigationModel
 
TARGET_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
TARGET_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
TARGET_SIZE - Static variable in class lejos.robotics.mapping.MapPanel
 
targetColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
TEMPERATURE - Static variable in interface lejos.nxt.remote.NXTProtocol
 
temperatureUnit - Variable in class lejos.nxt.addon.DIMUGyro
 
TextMenu - Class in lejos.util
Displays a list of items.
TextMenu(String[]) - Constructor for class lejos.util.TextMenu
This constructor sets location of the top row of the item list to row 0 of the display.
TextMenu(String[], int) - Constructor for class lejos.util.TextMenu
This constructor allows specification location of the item list .
TextMenu(String[], int, String) - Constructor for class lejos.util.TextMenu
This constuctor allows the specfication of a title (of up to 16 characters) and the location of the item list
The title is displayed in the row above the item list.
tiltUnit - Variable in class lejos.nxt.addon.DIMUAccel
The default unit to use when retuning tilt data from the accelerometer
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
TinyVM - Class in js.tinyvm
Deprecated. use lejos.pc.tools.NXJLink instead
TinyVM() - Constructor for class js.tinyvm.TinyVM
Deprecated.  
TinyVMConstants - Class in js.tinyvm
 
TinyVMConstants() - Constructor for class js.tinyvm.TinyVMConstants
 
TinyVMException - Exception in js.tinyvm
Generic tiny vm exception.
TinyVMException(String) - Constructor for exception js.tinyvm.TinyVMException
 
TinyVMException(Throwable) - Constructor for exception js.tinyvm.TinyVMException
 
TinyVMException(String, Throwable) - Constructor for exception js.tinyvm.TinyVMException
 
TinyVMTool - Class in js.tinyvm
Tiny VM.
TinyVMTool() - Constructor for class js.tinyvm.TinyVMTool
 
TinyVMType - Class in js.tinyvm
This class encapsulates all functionality regarding tiny vm types.
tinyVMType(Type) - Static method in class js.tinyvm.TinyVMType
Get tiny vm type from bcel type.
tinyVMType(byte) - Static method in class js.tinyvm.TinyVMType
Get tiny vm type from bcel type.
tinyVMTypeFromSignature(String) - Static method in class js.tinyvm.TinyVMType
Get tiny vm type from bcel signature.
title - Variable in class lejos.robotics.mapping.NavigationPanel
 
ToolException - Exception in js.common
Generic tool exception.
ToolException(String) - Constructor for exception js.common.ToolException
 
ToolException(Throwable) - Constructor for exception js.common.ToolException
 
ToolException(String, Throwable) - Constructor for exception js.common.ToolException
 
ToolProgressMonitor - Interface in js.common
Listener for progress of long running operations.
ToolsLogger - Class in lejos.pc.tools
 
ToolsLogger() - Constructor for class lejos.pc.tools.ToolsLogger
 
ToolsLogListener - Interface in lejos.pc.tools
 
toString() - Method in class js.tinyvm.ClassPath
 
toString() - Method in class js.tinyvm.ClassRecord
 
toString() - Method in class js.tinyvm.Signature
 
toString() - Method in class lejos.nxt.addon.IRSeekerV2
Returns a string representation of the strengths
toString() - Method in class lejos.robotics.navigation.Move
 
toString() - Method in class lejos.robotics.navigation.Pose
return string contains x,y and heading
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.
trackWidthField - Variable in class lejos.robotics.mapping.NavigationPanel
 
trackWidthLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
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.
Transmittable - Interface in lejos.robotics
 
transpose() - Method in class lejos.util.Matrix
Matrix transpose.
travel(float) - Method in class lejos.robotics.mapping.PCNavigationModel
Send a travel event to the NXT
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.OmniPilot
 
travel(double, double) - Method in class lejos.robotics.navigation.OmniPilot
This method causes the robot to travel in a linear path, similar to other travel() methods, except you can specify which direction to move (relative to the current robot heading).
travel(double, boolean) - Method in class lejos.robotics.navigation.OmniPilot
 
travel(double, double, boolean) - Method in class lejos.robotics.navigation.OmniPilot
This method causes the robot to travel in a linear path, similar to other travel() methods, except you can specify which direction to move (relative to the current robot heading).
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.OmniPilot
 
travelArc(double, double, boolean) - Method in class lejos.robotics.navigation.OmniPilot
 
travelArc(double, double, float) - Method in class lejos.robotics.navigation.OmniPilot
This method moves the robot in an arc, similar to the other OmniPilot.travelArc(double, double) methods, except you can choose any of the 360 degree directions relative to the current heading (0) of the robot, while keeping the heading of the robot pointed in the same direction during the move.
travelArc(double, double, float, boolean) - Method in class lejos.robotics.navigation.OmniPilot
This method moves the robot in an arc, similar to the other OmniPilot.travelArc(double, double) methods, except you can choose any of the 360 degree directions relative to the current heading (0) of the robot, while keeping the heading of the robot pointed in the same direction during the move.
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
 
twoBeeps() - Static method in class lejos.nxt.Sound
Beeps twice.
type() - Method in class js.tinyvm.TinyVMType
Get tiny vm type as byte.
type - Variable in class lejos.nxt.ColorSensor
 
TYPE_ANGLE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_ANGLE - Static variable in class lejos.pc.tools.NXJMonitor
 
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_CUSTOM - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_HISPEED - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LIGHT_ACTIVE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LIGHT_ACTIVE - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_LIGHT_INACTIVE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LIGHT_INACTIVE - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_LOWSPEED - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LOWSPEED - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_LOWSPEED_9V - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_LOWSPEED_9V - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_NO_SENSOR - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_NO_SENSOR - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_REFLECTION - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_REFLECTION - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_SOUND_DB - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_SOUND_DB - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_SOUND_DBA - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_SOUND_DBA - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_SWITCH - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_SWITCH - Static variable in class lejos.pc.tools.NXJMonitor
 
TYPE_TEMPERATURE - Static variable in interface lejos.nxt.SensorConstants
 
TYPE_TEMPERATURE - Static variable in class lejos.pc.tools.NXJMonitor
 

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 class lejos.nxt.remote.ErrorMessages
 
UNKNOWN_COMMAND_OPCODE - Static variable in class 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.
update() - Method in class lejos.nxt.addon.PFMate
Sends command to PF IR receiver to apply changes made to the registers.
update(byte[]) - Method in class lejos.nxt.LCD
 
update(byte[]) - Method in class lejos.pc.tools.LCDDisplay
 
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
 
updateDevice(NXTSamba, byte[], byte[], boolean) - Method in class lejos.pc.tools.NXJFlashUpdate
Update the NXT with the new memory image.
updateDevice(NXTSamba, byte[], byte[], boolean, boolean, boolean) - Method in class lejos.pc.tools.NXJFlashUpdate
 
updateImage() - Method in class lejos.pc.tools.NXJImagePicturePanel
 
updateImageFromCode() - Method in class lejos.pc.tools.NXJImageMainPanel
 
updateLCD(byte[]) - Method in class lejos.pc.tools.ConsoleViewerSwingUI
 
updateLCD(byte[]) - Method in interface lejos.pc.tools.ConsoleViewerUI
 
updateLCD(byte[]) - Method in class lejos.pc.tools.NXJConsole
 
updateLCD(byte[]) - Method in class lejos.pc.tools.NXJConsoleViewer
 
updateLCD(byte[]) - Method in class lejos.pc.tools.NXJControl
Used by console viewer
updateNxtPart() - Method in class lejos.pc.tools.NXJImageMainPanel
 
updatePose() - Method in class lejos.robotics.navigation.LegacyNavigator
Deprecated.  
updatePosition() - 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
 
Upload - Class in lejos.pc.tools
Utility class used by the nxj and nxjupload command line tools.
Upload() - Constructor for class lejos.pc.tools.Upload
 
upload(String, String, int, File, String, boolean) - Method in class lejos.pc.tools.Upload
 
uploadBox - Variable in class lejos.robotics.mapping.NavigationPanel
 
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
Use USB for the connection
usDelay(long) - Static method in class lejos.util.Delay
Wait for the specified number of microseconds.
useAll() - Method in class js.tinyvm.Binary
Return true if unused methods/classes etc.
useAllMethods() - Method in class js.tinyvm.ClassRecord
 
used() - Method in class js.tinyvm.ClassRecord
 
used() - Method in class js.tinyvm.ConstantRecord
 
used() - Method in class js.tinyvm.StaticFieldRecord
 

V

valid - Variable in class lejos.nxt.remote.InputValues
NXT indicates if it thinks the data is valid
value() - Method in class js.tinyvm.ConstantValue
Dereferenced value.
value - Variable in class lejos.pc.charting.DataItem
The Number wrapper object of the datatype.
valueChanged(ListSelectionEvent) - Method in class lejos.pc.tools.NXJControl
Switch between NXTS in table of available NXTs
valueOf(String) - Static method in enum js.tinyvm.DebugOptions
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum js.tinyvm.RunTimeOptions
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.DIMUAccel.AccelUnits
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.DIMUAccel.TiltUnits
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.DIMUGyro.Axis
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.DIMUGyro.Range
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.DIMUGyro.RateUnits
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.DIMUGyro.SampleRate
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum lejos.nxt.addon.DIMUGyro.TemperatureUnits
Returns the enum constant of this type with the specified name.
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.mapping.NavigationModel.NavEvent
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 js.tinyvm.DebugOptions
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum js.tinyvm.RunTimeOptions
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.nxt.addon.DIMUAccel.AccelUnits
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.nxt.addon.DIMUAccel.TiltUnits
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.nxt.addon.DIMUGyro.Axis
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.nxt.addon.DIMUGyro.Range
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.nxt.addon.DIMUGyro.RateUnits
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.nxt.addon.DIMUGyro.SampleRate
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.nxt.addon.DIMUGyro.TemperatureUnits
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.nxt.addon.IRSeekerV2.Mode
Returns an array containing the constants of this enum type, in the order they're 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're 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're declared.
values() - Static method in enum lejos.pc.comm.NXTConnectionState
Returns an array containing the constants of this enum type, in the order they're declared.
values() - Static method in enum lejos.robotics.mapping.NavigationModel.NavEvent
Returns an array containing the constants of this enum type, in the order they're 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're declared.
VERIFY_LEVEL - Static variable in class js.tinyvm.TinyVMConstants
 
verifyFilesystem(NXTSamba, byte[]) - Method in class lejos.pc.tools.NXJFlashUpdate
 
verifyFirmware(NXTSamba, byte[]) - Method in class lejos.pc.tools.NXJFlashUpdate
Verify the firware downloaded to the device.
verifyPages(NXTSamba, int, byte[]) - Method in class lejos.pc.tools.NXJFlashUpdate
Verify that the contents of the nxt flash memory match the supplied image.
VERSION - Static variable in class js.tinyvm.TinyVMConstants
 
viewCommands - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewConnect - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewControls - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewEventForm - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewGrid - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewLastMove - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewLoadMap - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewLog - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewMenu - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewMesh - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewMousePosition - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewParticlePanel - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewParticles - Variable in class lejos.robotics.mapping.NavigationPanel
 
viewStart - Variable in class lejos.robotics.mapping.MapPanel
 
voltage - Variable in class lejos.robotics.mapping.PCNavigationModel
 

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 class lejos.pc.tools.ConsoleViewComms
Wait for the console session to end
waitComplete() - Method in class lejos.robotics.MirrorMotor
 
waitComplete() - Method in interface lejos.robotics.RegulatedMotor
Wait until the current movement operation is complete (this can include the motor stalling).
waitForAnyPress() - Static method in class lejos.nxt.Button
 
waitForAnyPress(int) - Static method in class lejos.nxt.Button
 
waitForButtons(int) - Static method in class lejos.nxt.NXTFrame
 
waitForPressAndRelease() - Method in class lejos.nxt.Button
 
waitForStop() - Method in class lejos.robotics.navigation.Navigator
Waits for the robot to stop for any reason ; returns true if the robot stopped at the final Waypoint of the path.
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
 
WAYPOINT_COLOR - Static variable in class lejos.robotics.mapping.MapPanel
 
WAYPOINT_COLOR_INDEX - Static variable in class lejos.robotics.mapping.MapPanel
 
waypointColor - Variable in class lejos.robotics.mapping.NavigationPanel
 
WaypointListener - Interface in lejos.robotics.navigation
Interface for informing listeners that a way point has been generated.
waypoints - Variable in class lejos.robotics.mapping.PCNavigationModel
 
weight - Variable in class lejos.robotics.mapping.PCNavigationModel
 
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
wheelDiameterField - Variable in class lejos.robotics.mapping.NavigationPanel
 
wheelDiameterLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
whenConnected() - Method in class lejos.pc.tools.NXJMapCommand
Send the pose when connected
whenConnected() - Method in interface lejos.robotics.mapping.MapApplicationUI
Signal that the NXT is now connected
whenConnected() - Method in interface lejos.robotics.mapping.NavEventListener
 
whenConnected() - Method in class lejos.robotics.mapping.NavigationPanel
Override this method to specify actions to do after connection to the NXT
WHITE - Static variable in interface lejos.nxt.SensorConstants
 
WHITE - Static variable in class lejos.robotics.Color
 
WritableData - Interface in js.tinyvm
 
WritableDataWithOffset - Class in js.tinyvm
 
WritableDataWithOffset() - Constructor for class js.tinyvm.WritableDataWithOffset
 
write(byte[]) - Method in class js.tinyvm.io.ByteWriter
 
write(int) - Method in class js.tinyvm.io.ByteWriter
 
write(byte[]) - Method in interface js.tinyvm.io.IByteWriter
 
write(int) - Method in interface js.tinyvm.io.IByteWriter
 
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(byte[], int, int) - Method in class lejos.pc.comm.NXTCommOutputStream
 
write(int) - Method in class lejos.pc.comm.NXTCommOutputStream
 
write(byte[]) - Method in class lejos.pc.comm.NXTCommUSB
Write bytes to the device.
writeBoolean(boolean) - Method in class js.tinyvm.io.ByteWriter
 
writeBoolean(boolean) - Method in interface js.tinyvm.io.IByteWriter
 
writeByte(int) - Method in class js.tinyvm.io.ByteWriter
 
writeByte(int) - Method in interface js.tinyvm.io.IByteWriter
 
writeBytes(int, byte[]) - Method in class lejos.pc.comm.NXTSamba
Write a series of bytes to the device.
writeChar(int) - Method in class js.tinyvm.io.ByteWriter
 
writeChar(int) - Method in interface js.tinyvm.io.IByteWriter
 
writeDouble(double) - Method in class js.tinyvm.io.ByteWriter
 
writeDouble(double) - Method in interface js.tinyvm.io.IByteWriter
 
writeFile(byte, byte[], int, int) - Method in class lejos.nxt.remote.NXTCommand
Write data to the file
writeFilesystem(NXTSamba, byte[]) - Method in class lejos.pc.tools.NXJFlashUpdate
Format the nxt file system.
writeFirmware(NXTSamba, byte[]) - Method in class lejos.pc.tools.NXJFlashUpdate
Update the NXT with the new memory image.
writeFloat(float) - Method in class js.tinyvm.io.ByteWriter
 
writeFloat(float) - Method in interface js.tinyvm.io.IByteWriter
 
writeHalfword(int, int) - Method in class lejos.pc.comm.NXTSamba
Write a 16 bit halfword to the specified address.
writeInt(int) - Method in class js.tinyvm.io.ByteWriter
 
writeInt(int) - Method in interface js.tinyvm.io.IByteWriter
 
writeLong(long) - Method in class js.tinyvm.io.ByteWriter
 
writeLong(long) - Method in interface js.tinyvm.io.IByteWriter
 
writeOctet(int, int) - Method in class lejos.pc.comm.NXTSamba
Write a 8 bit octet to the specified address.
writePadding(IByteWriter, int) - Static method in class js.tinyvm.io.IOUtilities
Write padding bytes.
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.
writeShort(int) - Method in class js.tinyvm.io.ByteWriter
 
writeShort(int) - Method in interface js.tinyvm.io.IByteWriter
 
writeU1(int) - Method in class js.tinyvm.io.BEByteWriter
 
writeU1(int) - Method in interface js.tinyvm.io.IByteWriter
 
writeU1(int) - Method in class js.tinyvm.io.LEByteWriter
 
writeU2(int) - Method in class js.tinyvm.io.BEByteWriter
 
writeU2(int) - Method in interface js.tinyvm.io.IByteWriter
 
writeU2(int) - Method in class js.tinyvm.io.LEByteWriter
 
writeU4(int) - Method in class js.tinyvm.io.BEByteWriter
 
writeU4(int) - Method in interface js.tinyvm.io.IByteWriter
 
writeU4(int) - Method in class js.tinyvm.io.LEByteWriter
 
writeU8(long) - Method in class js.tinyvm.io.BEByteWriter
 
writeU8(long) - Method in interface js.tinyvm.io.IByteWriter
 
writeU8(long) - Method in class js.tinyvm.io.LEByteWriter
 
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.
xField - Variable in class lejos.robotics.mapping.NavigationPanel
 
xLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 
xyPanel - Variable in class lejos.robotics.mapping.NavigationPanel
 

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
 
yField - Variable in class lejos.robotics.mapping.NavigationPanel
 
yLabel - Variable in class lejos.robotics.mapping.NavigationPanel
 

Z

ZERO - Variable in class lejos.robotics.FixedRangeScanner
 
ZERO - Variable in class lejos.robotics.RotatingRangeScanner
 
zoomIncrement - Variable in class lejos.robotics.mapping.NavigationPanel
 
zoomInitialValue - Variable in class lejos.robotics.mapping.NavigationPanel
 
zoomMajorTick - Variable in class lejos.robotics.mapping.NavigationPanel
 
zoomSlider - Variable in class lejos.robotics.mapping.NavigationPanel
 

_

_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.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
_count - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder
 
_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.  
_height - Variable in class lejos.util.TextMenu
number of rows displayed; set by constructor, used by display()
_inside - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. The motor at the inside of the turn.
_items - Variable in class lejos.util.TextMenu
array of items to be displayed ;set by constructor, used by select();
_left - Variable in class lejos.robotics.navigation.DifferentialPilot
Left motor..
_left - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Left motor.
_leftDegPerDistance - Variable in class lejos.robotics.navigation.DifferentialPilot
Left motor degrees per unit of travel.
_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.
_length - Variable in class lejos.util.TextMenu
effective length of items array - number of items before null
_location - Variable in class lejos.robotics.navigation.Pose
 
_map - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder
The map of the obstacles
_monitors - Variable in class js.common.AbstractTool
 
_motorSpeed - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Motor speed degrees per second.
_outside - Variable in class lejos.robotics.navigation.DifferentialPilot
The motor at the outside of the turn.
_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
 
_predecessor - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
_quit - Variable in class lejos.util.TextMenu
boolean to cause select to quit
_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
_right - Variable in class lejos.robotics.navigation.DifferentialPilot
Right motor.
_right - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. Right motor.
_rightDegPerDistance - Variable in class lejos.robotics.navigation.DifferentialPilot
Right motor degrees per unit of travel.
_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.
_sourceDistance - Variable in class lejos.robotics.pathfinding.DijkstraPathFinder.Node
 
_startTime - Variable in class lejos.util.TextMenu
start time for select()
_steerRatio - Variable in class lejos.robotics.navigation.LegacyPilot
Deprecated. ratio of inside/outside motor speeds set by steer(turnRate) used by other steer methods;
_title - Variable in class lejos.util.TextMenu
optional menu title displayed immediately above the list of items
_topIndex - Variable in class lejos.util.TextMenu
index of the list item at the top of the list; set by constructor, used by select()
_topRow - Variable in class lejos.util.TextMenu
location of the top row of the list; set by constructor, used by display()
_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
 

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