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

acceleration(short, double[], double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the solution of the Forward Dynamics Problem.
acceleration(short, double[], double[], double[], double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the solution of the Forward Dynamics Problem with load applied to the last link.
acceleration(RVector, RVector, RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
acceleration(double[], double[], double[]) - Method in class javax.robotics.engine.robots.DHRobot
 
acceleration(RVector, RVector, RVector, RVector3d, RVector3d) - Method in class javax.robotics.engine.robots.DHRobot
 
acceleration(double[], double[], double[], double[], double[]) - Method in class javax.robotics.engine.robots.DHRobot
 
acceleration(RVector, RVector, RVector) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Forward Dynamics Problem.
acceleration(double[], double[], double[]) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Forward Dynamics Problem.
acceleration(RVector, RVector, RVector, RVector3d, RVector3d) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Forward Dynamics Problem with load applied to the last link.
acceleration(double[], double[], double[], double[], double[]) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Forward Dynamics Problem with load applied to the last link.
accept(File) - Method in class javax.robotics.image.ImageFileFilter
 
accept(File) - Method in class javax.robotics.xml.XmlFileFilter
 
actionPerformed(ActionEvent) - Method in class javax.robotics.image.ImageDisplayer
 
actionPerformed(ActionEvent) - Method in class javax.robotics.plot.MultiPlotFrame
 
actionPerformed(ActionEvent) - Method in class javax.robotics.swing.TipPanel
 
add(MultiPlot) - Method in class javax.robotics.plot.MultiPlotFrame
Adds a new plot to the window.
add(MultiPlot) - Method in class javax.robotics.plot.MultiPlotPanel
Adds a new plot to the panel.
add(RVector...) - Method in class javax.robotics.vecmath.RVector
Adds multiple vectors and puts the result in this vector.
addRobotToDefaultConfiguration(Robot3D) - Method in class javax.robotics.swing.RobotFrame
Creates the default scene 3D and adds to it the Robot3D object.
addRobotToDefaultConfiguration(Robot3D, Behavior) - Method in class javax.robotics.swing.RobotFrame
Creates the default scene 3D and adds to it the Robot3D object.
addRobotToDefaultConfiguration(Robot3D) - Method in class javax.robotics.swing.RobotPanel
Creates the default scene 3D and adds to it the Robot3D object.
addRobotToDefaultConfiguration(Robot3D, Behavior) - Method in class javax.robotics.swing.RobotPanel
Creates the default scene 3D and adds to it the Robot3D object.
addScale(double[], RVector...) - Method in class javax.robotics.vecmath.RVector
Adds multiple scaled vectors and puts the result in this vector.
addVector(double, RVector, boolean) - Method in class javax.robotics.plot.MultiPlot
Adds vector to the plot.
addVector(double, RVector3d, boolean) - Method in class javax.robotics.plot.MultiPlot
Adds vector to the plot.
addVector(int, double, RVector, boolean) - Method in class javax.robotics.plot.MultiPlot
Adds vector to the plot from specified dataset.
addVector(int, double, RVector3d, boolean) - Method in class javax.robotics.plot.MultiPlot
Adds vector to the plot from specified dataset.
append(String) - Method in class javax.robotics.swing.DisplayPanel
Append the input text in the window.
append(RVector) - Method in class javax.robotics.vecmath.RVector
Appends the input vector to this vector.
append(double[]) - Method in class javax.robotics.vecmath.RVector
Appends the input array to this vector.
append(RVector3d) - Method in class javax.robotics.vecmath.RVector
Appends the input vector to this vector.
arrayLeftDivide(Matrix) - Method in class javax.robotics.vecmath.Matrix
Element-by-element left division, C = this.
arrayLeftDivideEquals(Matrix) - Method in class javax.robotics.vecmath.Matrix
Element-by-element left division in place, this = this.
arrayRightDivide(Matrix) - Method in class javax.robotics.vecmath.Matrix
Element-by-element right division, C = this.
arrayRightDivideEquals(Matrix) - Method in class javax.robotics.vecmath.Matrix
Element-by-element right division in place, this = this.
Axes - Class in javax.robotics.j3d
Java3D utility class to draw the axes of cartesian space.
Axes() - Constructor for class javax.robotics.j3d.Axes
Default constructor with axes length 1.
Axes(float, boolean) - Constructor for class javax.robotics.j3d.Axes
Constructor with axes length.
Axis - Class in javax.robotics.j3d
Java3D utility class to draw the axes of cartesian space.
Axis() - Constructor for class javax.robotics.j3d.Axis
Default constructor.
Axis(float) - Constructor for class javax.robotics.j3d.Axis
Constructor with axes length.

B

BAD_DATA - Static variable in interface javax.robotics.engine.trajectory.Trajectory
Error type about spline interpolation.
BLACK - Static variable in interface javax.robotics.j3d.ColorConstants
 
BLUE - Static variable in interface javax.robotics.j3d.ColorConstants
 
BODY - Static variable in class javax.robotics.j3d.Cylinder
Disegno solo della superficie del cilindro
BOTTOM - Static variable in class javax.robotics.j3d.Cylinder
Disegno con la parte inferiore chiusa
Box - Class in javax.robotics.j3d
 
Box(double, double, double) - Constructor for class javax.robotics.j3d.Box
 

C

checkEigenValue(RVector) - Static method in class javax.robotics.vecmath.Matrix
Check the eigenvalues.
CholeskyDecomposition - Class in javax.robotics.vecmath.jama
Cholesky Decomposition.
CholeskyDecomposition(double[][], int) - Constructor for class javax.robotics.vecmath.jama.CholeskyDecomposition
Cholesky algorithm for symmetric and positive definite matrix.
CLIK - Interface in javax.robotics.engine.clik
Closed Loop Inverse Kinematic algorithms interface for robots manipulator.
ClikJacobianInverse - Class in javax.robotics.engine.clik
Closed Loop Inverse Kinematics with Jacobian inverse.
ClikJacobianInverse(Robot, DMatrix, DMatrix) - Constructor for class javax.robotics.engine.clik.ClikJacobianInverse
Costructor with default sample time, dt = 1e-3 and eps = 0.02, lambdaMax=0.02.
ClikJacobianInverse(Robot, DMatrix, DMatrix, double) - Constructor for class javax.robotics.engine.clik.ClikJacobianInverse
Costructor with eps = 0.02, lambdaMax=0.02.
ClikJacobianInverse(Robot, DMatrix, DMatrix, double, double, double) - Constructor for class javax.robotics.engine.clik.ClikJacobianInverse
Constructor.
ClikJacobianPosInverse - Class in javax.robotics.engine.clik
Closed Loop Inverse Kinematics with positional Jacobian inverse.
ClikJacobianPosInverse(Robot, DMatrix) - Constructor for class javax.robotics.engine.clik.ClikJacobianPosInverse
Costructor with default sample time, dt = 1e-3 and eps = 0.02, lambdaMax=0.02, the space dimension = 3.
ClikJacobianPosInverse(Robot, DMatrix, int) - Constructor for class javax.robotics.engine.clik.ClikJacobianPosInverse
Costructor with default sample time, dt = 1e-3 and eps = 0.02, lambdaMax=0.02.
ClikJacobianPosInverse(Robot, DMatrix, int, double) - Constructor for class javax.robotics.engine.clik.ClikJacobianPosInverse
Costructor with eps = 0.02, lambdaMax=0.02.
ClikJacobianPosInverse(Robot, DMatrix, double, int, double, double) - Constructor for class javax.robotics.engine.clik.ClikJacobianPosInverse
Constructor.
ClikJacobianPosTranspose - Class in javax.robotics.engine.clik
Closed Loop Inverse Kinematics with positional Jacobian transpose.
ClikJacobianPosTranspose(Robot, DMatrix, int) - Constructor for class javax.robotics.engine.clik.ClikJacobianPosTranspose
Costructor with default sample time, dt = 1e-3.
ClikJacobianPosTranspose(Robot, DMatrix, int, double) - Constructor for class javax.robotics.engine.clik.ClikJacobianPosTranspose
Costructor.
ClikJacobianTranspose - Class in javax.robotics.engine.clik
Closed Loop Inverse Kinematics with Jacobian transpose.
ClikJacobianTranspose(Robot, DMatrix, DMatrix) - Constructor for class javax.robotics.engine.clik.ClikJacobianTranspose
Costructor with default sample time, dt = 1e-3.
ClikJacobianTranspose(Robot, DMatrix, DMatrix, double) - Constructor for class javax.robotics.engine.clik.ClikJacobianTranspose
Costructor.
CLIKR - Interface in javax.robotics.engine.clik
Closed Loop Inverse Kinematic algorithms interface for redundant robots manipulator.
CLIKRSimulation - Class in javax.robotics.simulator
CLIK simulation helper class for redundant robot manipulators.
CLIKRSimulation(Robot3D, CLIKR, Trajectory, int) - Constructor for class javax.robotics.simulator.CLIKRSimulation
 
CLIKSimulation - Class in javax.robotics.simulator
 
CLIKSimulation(Robot3D, CLIK, Trajectory, int) - Constructor for class javax.robotics.simulator.CLIKSimulation
 
ClikWithConstraintSimulation - Class in javax.robotics.simulator
 
ClikWithConstraintSimulation(Robot3D, CLIKR, ConstraintVelocity, Trajectory, int) - Constructor for class javax.robotics.simulator.ClikWithConstraintSimulation
 
CollisionDetector - Class in javax.robotics.j3d
This class implements a simple collision detector.
CollisionDetector(Node) - Constructor for class javax.robotics.j3d.CollisionDetector
Collision Detector Constructor.
ColorConstants - Interface in javax.robotics.j3d
Java3D utility class
compute(RVector) - Method in class javax.robotics.engine.clik.ConstraintFunction
Computes the constraint velocity as gradient of function w(q).
compute(RVector) - Method in interface javax.robotics.engine.clik.ConstraintVelocity
Computes the constraint velocity q0'.
compute(RVector) - Method in class javax.robotics.engine.clik.JointStrokeConstraint
Computes the constraint velocity function.
ComputedTorque - Class in javax.robotics.engine.controllers
This class implements Computed Torque Method joints position controller.
ComputedTorque(Robot, DMatrix, DMatrix) - Constructor for class javax.robotics.engine.controllers.ComputedTorque
Computed Torque Method position controller class constructor.
ComputedTorque(Robot, double[], double[]) - Constructor for class javax.robotics.engine.controllers.ComputedTorque
Computed Torque Method position controller class constructor.
cond() - Method in class javax.robotics.vecmath.jama.SingularValueDecomposition
Two norm condition number
ConstraintFunction - Class in javax.robotics.engine.clik
Interface for the constraint function w(q).
ConstraintFunction(double) - Constructor for class javax.robotics.engine.clik.ConstraintFunction
 
ConstraintVelocity - Interface in javax.robotics.engine.clik
Interface for computing the constraint velocity.
control(double[], double[], double[], double[], double[], double[], double[], double[], double) - Method in class javax.robotics.engine.controllers.ImpedanceControl
Sets the compliant trajectory for a desired trajectory effector: acceleration, velocity, position, angular acceleration, angular velocity, angular position.
Controller - Interface in javax.robotics.engine.controllers
Interface for different schemes of robot position controller.
create() - Method in class javax.robotics.plot.MultiPlotFrame
Creates and displays the window.
createComputedTorqueMethod(short, short, double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Computed Torque Method position controller class constructor.
createDesktopImage() - Method in class javax.robotics.image.ScreenImage
Convenience method to create a BufferedImage of the desktop
createGravityCompensation(short, short, double, double, double, double) - Method in class javax.robotics.engine.JRoboOp
Gravity Compensation controller class constructor.
createImage(JComponent) - Method in class javax.robotics.image.ScreenImage
 
createImage(JComponent, Rectangle) - Method in class javax.robotics.image.ScreenImage
 
createImage(Component) - Method in class javax.robotics.image.ScreenImage
 
createImage(Rectangle) - Method in class javax.robotics.image.ScreenImage
Create a BufferedImage from a rectangular region on the screen.
createImpedance(short, short, double[], double[], double[], double[], double[], double[], double[]) - Method in class javax.robotics.engine.JRoboOp
 
createPDGravityComp(short, short, double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Proportional Derivative with gravity compensation joints position controller class constructor.
createProportionalDerivative(short, short, double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Proportional Derivative joints position controller class constructor.
createResolveRateAcceleration(short, short, double, double, double, double) - Method in class javax.robotics.engine.JRoboOp
Resolved Rate Acceleration controller class constructor.
createRobot(short) - Method in class javax.robotics.engine.JRoboOp
Default Robot constructor.
createRobot(short, double[], int, int) - Method in class javax.robotics.engine.JRoboOp
Robot constructor with init parameter and motor parameter.
createRobot(short, double[], int, int, double[], int, int) - Method in class javax.robotics.engine.JRoboOp
Robot constructor with init parameter and motor parameter.
createRobot(short, String, String) - Method in class javax.robotics.engine.JRoboOp
Robot constructor with ROBOOP file parameter.
createRobustControl(short, short, double[], double[], double[], double[], double, double) - Method in class javax.robotics.engine.JRoboOp
Robust control position controller class constructor.
createSplinePath(short, int, int, double[]) - Method in class javax.robotics.engine.JRoboOp
Spline Path class constructor from ROBOOP file.
createSplineQuaternion(short, int, double[]) - Method in class javax.robotics.engine.JRoboOp
Spline Quaternion class constructor from array.
CYAN - Static variable in interface javax.robotics.j3d.ColorConstants
 
Cylinder - Class in javax.robotics.j3d
Cilindro con la possibilit?
Cylinder() - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggio 1.0 e lunghezza 2.0 che si sviluppa lungo l'asse Z.
Cylinder(Point3d, double, double) - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggio r e lunghezza l che si sviluppa lungo l'asse Z.
Cylinder(Point3d, double, double, int) - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggio r e lunghezza l che si sviluppa lungo l'asse Z.
Cylinder(Point3d, double, double, int, int) - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggio r e lunghezza l.
Cylinder(Point3d, double, double, int, int, int) - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggio r e lunghezza l.
Cylinder(Point3d, double, double, double) - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggi rb, rt e lunghezza l che si sviluppa lungo l'asse Z.
Cylinder(Point3d, double, double, double, int) - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggi rb, rt e lunghezza l che si sviluppa lungo l'asse Z.
Cylinder(Point3d, double, double, double, int, int) - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggi rb, rt e lunghezza l.
Cylinder(Point3d, double, double, double, int, int, int) - Constructor for class javax.robotics.j3d.Cylinder
Costruttore di un cilindro di raggi rb, rt e lunghezza l.

D

DBLUE - Static variable in interface javax.robotics.j3d.ColorConstants
 
DEBUG - Static variable in interface javax.robotics.engine.robots.Robot
 
DEFINITE_NEGATIVE - Static variable in class javax.robotics.vecmath.Matrix
Type of matrix.
DEFINITE_POSITIVE - Static variable in class javax.robotics.vecmath.Matrix
Type of matrix.
DerivableFunction - Interface in javax.robotics.ode
This class is an interface to define differential equation.
DerivableFunction2 - Interface in javax.robotics.ode
This class is an interface to define a second order differential equation.
det() - Method in class javax.robotics.vecmath.jama.LUDecomposition
Determinant
DHRobot - Class in javax.robotics.engine.robots
This class implements kinematics and dynamics model of a robot manipulator based on Denavit-Hartenberg table.
DHRobot() - Constructor for class javax.robotics.engine.robots.DHRobot
Default Robot constructor.
DHRobot(int, double[]) - Constructor for class javax.robotics.engine.robots.DHRobot
Robot constructor with init parameter.
DHRobot(int, double[], double[]) - Constructor for class javax.robotics.engine.robots.DHRobot
Robot constructor with init parameter and motor parameter.
DHRobot(String, String) - Constructor for class javax.robotics.engine.robots.DHRobot
Deprecated.  
DHRobot(URI) - Constructor for class javax.robotics.engine.robots.DHRobot
Robot constructor with URI of xml file parameter.
DHRobot(String) - Constructor for class javax.robotics.engine.robots.DHRobot
Robot constructor with xml file parameter.
DHRobot(File) - Constructor for class javax.robotics.engine.robots.DHRobot
Robot constructor with file parameter.
DHRobot(InputStream) - Constructor for class javax.robotics.engine.robots.DHRobot
Robot constructor with xml file parameter as input stream.
DHRobot3D - Class in javax.robotics.engine.robots
This class implements graphic 3D, kinematics and dynamics model of a robot manipulator based on Denavit-Hartenberg table.
DHRobot3D(int, double[]) - Constructor for class javax.robotics.engine.robots.DHRobot3D
Robot constructor with init parameter.
DHRobot3D(int, double[], double[]) - Constructor for class javax.robotics.engine.robots.DHRobot3D
Robot constructor with init parameter and motor parameter.
DHRobot3D(URI) - Constructor for class javax.robotics.engine.robots.DHRobot3D
Robot constructor with URI of xml file parameter.
DHRobot3D(String) - Constructor for class javax.robotics.engine.robots.DHRobot3D
Robot constructor with xml file parameter.
DHRobot3D(File) - Constructor for class javax.robotics.engine.robots.DHRobot3D
Robot constructor with xml file parameter.
DHRobot3D(InputStream) - Constructor for class javax.robotics.engine.robots.DHRobot3D
Robot constructor with xml file parameter as input stream.
DisplayPanel - Class in javax.robotics.swing
This class creates a panel to display output information.
DisplayPanel(String) - Constructor for class javax.robotics.swing.DisplayPanel
Constructor of sizeable window with texta area.
DMatrix - Class in javax.robotics.vecmath
Diagonal Matrix, a double precision, general, dynamically-resizable, one-dimensional vector class.
DMatrix(int) - Constructor for class javax.robotics.vecmath.DMatrix
Constructs a zero diagonal matrix size by size
DMatrix(double...) - Constructor for class javax.robotics.vecmath.DMatrix
Constructs a new diagonal matrix from an array.
DMatrix(RVector) - Constructor for class javax.robotics.vecmath.DMatrix
Constructs a new diagonal matrix from a vector.
DMatrix(DMatrix) - Constructor for class javax.robotics.vecmath.DMatrix
Constructs a new diagonal matrix from another diagonal matrix.
DMatrix(Matrix) - Constructor for class javax.robotics.vecmath.DMatrix
Constructs a new diagonal matrix from a diagonal of input matrix.
doRender(int, int) - Method in class javax.robotics.j3d.OffScreenCanvas3D
 
dot(Quaternion) - Method in class javax.robotics.vecmath.Quaternion
 
dTdqi(short, int) - Method in class javax.robotics.engine.JRoboOp
Computes the partial derivative of homogeneous transform respect j-th joint.
dTdqi(int) - Method in class javax.robotics.engine.robots.DHRobot
 
dTdqi(int) - Method in interface javax.robotics.engine.robots.Robot
Computes the partial derivative of homogeneous transform respect j-th joint.
DYELLOW - Static variable in interface javax.robotics.j3d.ColorConstants
 
DynamicsPanel - Class in javax.robotics.swing
This class creates a panel with spinner for dynamics.
DynamicsPanel(Robot3D, RVector3d, RVector3d) - Constructor for class javax.robotics.swing.DynamicsPanel
Constructor of the panel.

E

eig(Matrix, Matrix) - Method in class javax.robotics.vecmath.Matrix
Eigenvalues and eigenvectors of a nxn real matrix.
eig(Matrix, Matrix, RVector, RVector) - Method in class javax.robotics.vecmath.Matrix
Eigenvalues and eigenvectors of a nxn real matrix.
eig(RVector) - Method in class javax.robotics.vecmath.Matrix
Eigenvalues of a nxn real matrix.
eig() - Method in class javax.robotics.vecmath.Matrix
Eigenvalues of a nxn real matrix.
EigenvalueDecomposition - Class in javax.robotics.vecmath.jama
Eigenvalues and eigenvectors of a real matrix.
EigenvalueDecomposition(double[][], int) - Constructor for class javax.robotics.vecmath.jama.EigenvalueDecomposition
Check for symmetry, then construct the eigenvalue decomposition
EndEffController - Interface in javax.robotics.engine.controllers
Interface for different schemes of robot end effector position and orientation controller.
EndEffControlSimulation - Class in javax.robotics.simulator
End effector control simulation helper class.
EndEffControlSimulation(Robot3D, EndEffController, Solver2, Trajectory, int) - Constructor for class javax.robotics.simulator.EndEffControlSimulation
 
EndEffPosControlSimulation - Class in javax.robotics.simulator
 
EndEffPosControlSimulation(Robot3D, EndEffController, Solver2, Trajectory, int) - Constructor for class javax.robotics.simulator.EndEffPosControlSimulation
 
Euler - Class in javax.robotics.ode
This class implements forward Euler integration method.
Euler(double, RVector, DerivableFunction) - Constructor for class javax.robotics.ode.Euler
Defines numerical integration for x' = f(x) differential equation.
Euler2 - Class in javax.robotics.ode
This class implements forward Euler integration method for systems of two first order differential equations.
Euler2(double, RVector, RVector) - Constructor for class javax.robotics.ode.Euler2
Defines numerical integration for x'' = f(x, x') as system of two first order differential equation.
Euler2(double, RVector, RVector, DerivableFunction2) - Constructor for class javax.robotics.ode.Euler2
Defines numerical integration for x'' = f(x, x') as system of two first order differential equation.
ExternalForcePanel - Class in javax.robotics.swing
This class creates a panel of spinner for external forces an torques.
ExternalForcePanel(RVector3d, RVector3d) - Constructor for class javax.robotics.swing.ExternalForcePanel
Creates the panel of spinners for input forces and torques.

F

FileBrowserDialog - Class in javax.robotics.swing
Dialog panel to select a remote or local file.
FileBrowserDialog(String, String) - Constructor for class javax.robotics.swing.FileBrowserDialog
Dialog Constructor.
fillPlots() - Method in class javax.robotics.plot.MultiPlotPanel
 
function(RVector) - Method in class javax.robotics.engine.clik.ConstraintFunction
Interface for the constraint function w(q).

G

get(Matrix) - Method in class javax.robotics.vecmath.DMatrix
Gets this diagonal matrix as generic matrix.
get(double[]) - Method in class javax.robotics.vecmath.Matrix
Gets this matrix as mono dimensional array
get(double[][]) - Method in class javax.robotics.vecmath.Matrix
Gets this matrix as bi-dimensional array
get(double[]) - Method in class javax.robotics.vecmath.RMatrix4d
Gets this matrix as mono dimensional array
get(double[]) - Method in class javax.robotics.vecmath.RVector
Gets this vector as array
get3DRootBranch() - Method in class javax.robotics.swing.RobotFrame
Gets the root BranchGroup of 3D scene.
get3DRootBranch() - Method in class javax.robotics.swing.RobotPanel
Gets the root BranchGroup of 3D scene.
getA() - Method in class javax.robotics.xml.XmlRobot
Gets the DH parameters a.
getAlfa() - Method in class javax.robotics.xml.XmlRobot
Gets the DH parameters α.
getAvailableDof() - Method in class javax.robotics.engine.robots.DHRobot
 
getAvailableDof() - Method in interface javax.robotics.engine.robots.Robot
Gets the available degrees of freedom of robot.
getAvDof(short) - Method in class javax.robotics.engine.JRoboOp
Gets the available degrees of freedom of robot.
getBackground() - Method in class javax.robotics.j3d.Robot3DSceneGraph
Gets the child background.
getCartesianSpaceDim() - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
getCartesianSpaceDim() - Method in interface javax.robotics.engine.clik.CLIKR
Gets the dimension of cartesian space.
getConverge() - Method in class javax.robotics.engine.controllers.ImpedanceControl
Gets converge flag.
getConverge(short) - Method in class javax.robotics.engine.JRoboOp
 
getD() - Method in class javax.robotics.vecmath.jama.EigenvalueDecomposition
Return the block diagonal eigenvalue matrix
getD() - Method in class javax.robotics.xml.XmlRobot
Gets the DH parameters d.
getDescription() - Method in class javax.robotics.image.ImageFileFilter
 
getDescription() - Method in class javax.robotics.xml.XmlFileFilter
 
getDescription() - Method in class javax.robotics.xml.XmlRobot
Gets the tag description of the file.
getDescription() - Method in class javax.robotics.xml.XmlSpline
Gets the tag description of the file.
getDescription() - Method in class javax.robotics.xml.XmlTrapezoidal
Gets the tag description of the file.
getDiagonal() - Method in class javax.robotics.vecmath.Matrix
Gets main diagonal of this matrix.
getDof(short) - Method in class javax.robotics.engine.JRoboOp
Gets the degrees of freedom of robot.
getDof() - Method in class javax.robotics.engine.robots.DHRobot
 
getDof() - Method in interface javax.robotics.engine.robots.Robot
Gets the degrees of freedom of robot.
getDof() - Method in class javax.robotics.xml.XmlRobot
Gets the tag dof of the file.
getDoublePivot() - Method in class javax.robotics.vecmath.jama.LUDecomposition
Return pivot permutation vector as a one-dimensional double array
getEps() - Method in interface javax.robotics.engine.clik.CLIK
Gets the singular region area.
getEps() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the singular region area.
getEps() - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
getEps() - Method in interface javax.robotics.engine.clik.CLIKR
Gets the singular region area.
getError() - Method in class javax.robotics.engine.controllers.ImpedanceControl
Gets error flag.
getError(short) - Method in class javax.robotics.engine.JRoboOp
 
getError() - Method in class javax.robotics.engine.trajectory.Spline
Gets error flag.
getError() - Method in interface javax.robotics.engine.trajectory.Trajectory
Gets error flag.
getError() - Method in class javax.robotics.engine.trajectory.Trapezoidal
 
getExternalForcePanel() - Method in class javax.robotics.swing.DynamicsPanel
Gets the external force panel.
getFile() - Method in class javax.robotics.swing.FileBrowserDialog
Gets the URI file.
getFile() - Method in class javax.robotics.util.RemoteFile
Gets the remote file.
getFile() - Method in class javax.robotics.xml.XmlFileChooser
Gets the file.
getFileName() - Method in class javax.robotics.image.ImageFileChooser
Gets the canonical name of the choosen file.
getFileName() - Method in class javax.robotics.xml.XmlFileChooser
Gets the canonical name of the choosen file.
getFinalPosition() - Method in class javax.robotics.xml.XmlTrapezoidal
Gets the final positions of the path.
getFinalTime() - Method in class javax.robotics.xml.XmlTrapezoidal
Gets the final times of the path.
getGravity(short) - Method in class javax.robotics.engine.JRoboOp
Gets gravity vector.
getGravity() - Method in class javax.robotics.engine.robots.DHRobot
 
getGravity() - Method in interface javax.robotics.engine.robots.Robot
Gets gravity vector.
getGravityPanel() - Method in class javax.robotics.swing.DynamicsPanel
Gets the gravity panel.
getH() - Method in class javax.robotics.vecmath.jama.QRDecomposition
Return the Householder vectors
getID() - Method in class javax.robotics.engine.controllers.ComputedTorque
Gets Controller class ID.
getID() - Method in interface javax.robotics.engine.controllers.Controller
Gets Controller class ID.
getID() - Method in class javax.robotics.engine.controllers.GravityCompensation
Gets Controller class ID.
getID() - Method in class javax.robotics.engine.controllers.ImpedanceControl
Gets Controller class ID.
getID() - Method in class javax.robotics.engine.controllers.PDGravityCompensation
Gets Controller class ID.
getID() - Method in class javax.robotics.engine.controllers.ProportionalDerivative
Gets Controller class ID.
getID() - Method in class javax.robotics.engine.controllers.ResolvedRateAcceleration
Gets Controller class ID.
getID() - Method in class javax.robotics.engine.controllers.RobustControl
Gets Controller class ID.
getID() - Method in class javax.robotics.engine.JRoboOp
Gets the ID.
getID() - Method in class javax.robotics.engine.robots.DHRobot
Gets Robot class ID
getID() - Method in interface javax.robotics.engine.robots.Robot
Gets Robot class ID
getID() - Method in class javax.robotics.engine.trajectory.Spline
Gets Trajectory class ID.
getID() - Method in interface javax.robotics.engine.trajectory.Trajectory
Gets Trajectory class ID.
getID() - Method in class javax.robotics.engine.trajectory.Trapezoidal
 
getImagEigenvalues() - Method in class javax.robotics.vecmath.jama.EigenvalueDecomposition
Return the imaginary parts of the eigenvalues
getImmobile() - Method in class javax.robotics.xml.XmlRobot
Gets the immobile flags.
getInitialCondition() - Method in class javax.robotics.ode.Euler
 
getInitialCondition() - Method in interface javax.robotics.ode.Solver
Gets the initial condition for position x(0).
getInitialConditionPosition() - Method in class javax.robotics.ode.Euler2
 
getInitialConditionPosition() - Method in interface javax.robotics.ode.Solver2
Gets the initial condition for position x(0).
getInitialConditionVelocity() - Method in class javax.robotics.ode.Euler2
 
getInitialConditionVelocity() - Method in interface javax.robotics.ode.Solver2
Gets the initial condition for velocity x'(0).
getInitialPosition() - Method in class javax.robotics.xml.XmlTrapezoidal
Gets the initial positions of the path.
getJointData() - Method in class javax.robotics.simulator.CLIKRSimulation
 
getJointData() - Method in class javax.robotics.simulator.CLIKSimulation
 
getJointData() - Method in class javax.robotics.simulator.EndEffControlSimulation
 
getJointData() - Method in class javax.robotics.simulator.JointControlSimulation
 
getJointPanel() - Method in class javax.robotics.swing.KinematicsPanel
Gets the joints command panel.
getJointsPosition() - Method in interface javax.robotics.engine.clik.CLIK
Gets the current joints position.
getJointsPosition() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the current joints position.
getJointsPosition() - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
Gets the current joints position.
getJointsPosition() - Method in interface javax.robotics.engine.clik.CLIKR
Gets the current joints position.
getJointsVelocity() - Method in interface javax.robotics.engine.clik.CLIK
Gets the current joints velocity.
getJointsVelocity() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the current joints velocity.
getJointsVelocity() - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
Gets the current joints velocity.
getJointsVelocity() - Method in interface javax.robotics.engine.clik.CLIKR
Gets the current joints velocity.
getK0() - Method in class javax.robotics.engine.clik.ConstraintFunction
 
getK0() - Method in interface javax.robotics.engine.clik.ConstraintVelocity
Gets the velocity constraint gain.
getK0() - Method in class javax.robotics.engine.clik.JointStrokeConstraint
 
getKd() - Method in class javax.robotics.engine.controllers.ComputedTorque
 
getKd() - Method in interface javax.robotics.engine.controllers.JointController
Gets the velocity error gain matrix.
getKd() - Method in class javax.robotics.engine.controllers.PDGravityCompensation
 
getKd() - Method in class javax.robotics.engine.controllers.ProportionalDerivative
 
getKd() - Method in class javax.robotics.engine.controllers.RobustControl
 
getKo() - Method in interface javax.robotics.engine.clik.CLIK
Gets the matrix of error orientation gain.
getKo() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the matrix of error orientation gain.
getKp() - Method in interface javax.robotics.engine.clik.CLIK
Gets the matrix of error position gain.
getKp() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the matrix of error position gain.
getKp() - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
getKp() - Method in interface javax.robotics.engine.clik.CLIKR
Gets the matrix of error position gain.
getKp() - Method in class javax.robotics.engine.controllers.ComputedTorque
 
getKp() - Method in interface javax.robotics.engine.controllers.JointController
Gets the position error gain matrix.
getKp() - Method in class javax.robotics.engine.controllers.PDGravityCompensation
 
getKp() - Method in class javax.robotics.engine.controllers.ProportionalDerivative
 
getKp() - Method in class javax.robotics.engine.controllers.RobustControl
 
getL() - Method in class javax.robotics.vecmath.jama.CholeskyDecomposition
Return triangular factor.
getL() - Method in class javax.robotics.vecmath.jama.LUDecomposition
Return lower triangular factor
getLambdaMax() - Method in interface javax.robotics.engine.clik.CLIK
Gets the maximum damped factor.
getLambdaMax() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the maximum damped factor.
getLambdaMax() - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
getLambdaMax() - Method in interface javax.robotics.engine.clik.CLIKR
Gets the maximum damped factor.
getLastValue() - Method in class javax.robotics.ode.Euler
 
getLastValue() - Method in interface javax.robotics.ode.Solver
Gets the current value of position x computed by step function.
getLastValuePosition() - Method in class javax.robotics.ode.Euler2
 
getLastValuePosition() - Method in interface javax.robotics.ode.Solver2
Gets the current value of position x computed by step function.
getLastValueVelocity() - Method in class javax.robotics.ode.Euler2
 
getLastValueVelocity() - Method in interface javax.robotics.ode.Solver2
Gets the current value of velocity x'computed by step function.
getLinkData() - Method in class javax.robotics.xml.XmlRobot
Gets the array of data about all the links of the robot.
getMaximumVelocity() - Method in class javax.robotics.xml.XmlTrapezoidal
Gets the maximum velocities of the path.
getModel3D() - Method in class javax.robotics.engine.robots.DHRobot3D
 
getModel3D() - Method in interface javax.robotics.engine.robots.Robot3D
Gets the model 3D of robot manipulator.
getMotorData() - Method in class javax.robotics.xml.XmlRobot
Gets the motor data of the links.
getName() - Method in class javax.robotics.xml.XmlRobot
Gets the tag name of the file.
getName() - Method in class javax.robotics.xml.XmlSpline
Gets the tag name of the file.
getName() - Method in class javax.robotics.xml.XmlTrapezoidal
Gets the tag name of the file.
getNLinks() - Method in class javax.robotics.xml.XmlRobot
Gets the number of links
getNumberOfPoints() - Method in class javax.robotics.xml.XmlSpline
Gets the number of points of path
getOffScreenCanvas3D() - Method in class javax.robotics.j3d.RobotCanvas3D
Gets the off screen canvas so that it can be rendered as an image.
getOrientationData() - Method in class javax.robotics.engine.trajectory.Spline
Gets the orientation data as matrix.
getOrientationError() - Method in interface javax.robotics.engine.clik.CLIK
Gets the current orientation error.
getOrientationError() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the current orientation error.
getOrientationError() - Method in interface javax.robotics.engine.controllers.EndEffController
Gets the current orientation error.
getOrientationError() - Method in class javax.robotics.engine.controllers.GravityCompensation
 
getOrientationError() - Method in class javax.robotics.engine.controllers.ResolvedRateAcceleration
 
getOrientationPathAsMatrix() - Method in class javax.robotics.xml.XmlSpline
Gets orientation path data.
getPivot() - Method in class javax.robotics.vecmath.jama.LUDecomposition
Return pivot permutation vector
getPlotPanel() - Method in class javax.robotics.simulator.CLIKRSimulation
 
getPlotPanel() - Method in class javax.robotics.simulator.CLIKSimulation
 
getPlotPanel() - Method in class javax.robotics.simulator.EndEffControlSimulation
 
getPlotPanel() - Method in class javax.robotics.simulator.JointControlSimulation
 
getPosErrorGCOMP(short) - Method in class javax.robotics.engine.JRoboOp
Gets the position error.
getPosErrorRRA(short) - Method in class javax.robotics.engine.JRoboOp
Gets the position error.
getPositionData() - Method in class javax.robotics.engine.trajectory.Spline
Gets the position data as matrix.
getPositionError() - Method in interface javax.robotics.engine.clik.CLIK
Gets the current position error.
getPositionError() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the current position error.
getPositionError() - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
getPositionError() - Method in interface javax.robotics.engine.clik.CLIKR
Gets the current position error.
getPositionError() - Method in interface javax.robotics.engine.controllers.EndEffController
Gets the position error.
getPositionError() - Method in class javax.robotics.engine.controllers.GravityCompensation
 
getPositionError() - Method in class javax.robotics.engine.controllers.ResolvedRateAcceleration
 
getPositionPathAsMatrix() - Method in class javax.robotics.xml.XmlSpline
Gets position path data.
getQ(short) - Method in class javax.robotics.engine.JRoboOp
Gets joints position.
getQ(short, int) - Method in class javax.robotics.engine.JRoboOp
Gets the position of i-th joint.
getQ() - Method in class javax.robotics.engine.robots.DHRobot
 
getQ(int) - Method in class javax.robotics.engine.robots.DHRobot
 
getQ() - Method in interface javax.robotics.engine.robots.Robot
Gets joints position.
getQ(int) - Method in interface javax.robotics.engine.robots.Robot
Position of i-th joint.
getQ() - Method in class javax.robotics.vecmath.jama.QRDecomposition
Generate and return the (economy-sized) orthogonal factor
getQMax(short) - Method in class javax.robotics.engine.JRoboOp
Gets joints maximum position.
getQMax() - Method in class javax.robotics.engine.robots.DHRobot
 
getQMax() - Method in interface javax.robotics.engine.robots.Robot
Gets joints maximum position.
getQMax() - Method in class javax.robotics.xml.XmlRobot
Gets the array of theta-max or d-max tags of the links.
getQMin(short) - Method in class javax.robotics.engine.JRoboOp
Gets joints minumum position.
getQMin() - Method in class javax.robotics.engine.robots.DHRobot
 
getQMin() - Method in interface javax.robotics.engine.robots.Robot
Gets joints minimum position.
getQMin() - Method in class javax.robotics.xml.XmlRobot
Gets the array of theta-min or d-min tags of the links.
getQOffset(short) - Method in class javax.robotics.engine.JRoboOp
Gets joints minumum position.
getQOffset() - Method in class javax.robotics.engine.robots.DHRobot
 
getQOffset() - Method in interface javax.robotics.engine.robots.Robot
Gets joints offset position.
getQOffset() - Method in class javax.robotics.xml.XmlRobot
Gets the array of offset tag of the links.
getQp(short) - Method in class javax.robotics.engine.JRoboOp
Gets joints velocity.
getQp() - Method in class javax.robotics.engine.robots.DHRobot
 
getQp() - Method in interface javax.robotics.engine.robots.Robot
Gets joints velocity.
getQpp(short) - Method in class javax.robotics.engine.JRoboOp
Gets joints acceleration.
getQpp() - Method in class javax.robotics.engine.robots.DHRobot
 
getQpp() - Method in interface javax.robotics.engine.robots.Robot
Gets joints acceleration.
getQuaternion() - Method in class javax.robotics.vecmath.RMatrix3d
Get the quaternion from this matrix.
getQuatErrorGCOMP(short) - Method in class javax.robotics.engine.JRoboOp
Gets the quaternion error.
getQuatErrorRRA(short) - Method in class javax.robotics.engine.JRoboOp
Gets the quaternion error.
getR() - Method in class javax.robotics.vecmath.jama.QRDecomposition
Return the upper triangular factor
getRealEigenvalues() - Method in class javax.robotics.vecmath.jama.EigenvalueDecomposition
Return the real parts of the eigenvalues
getRobotConfiguration() - Method in class javax.robotics.engine.robots.DHRobot
 
getRobotConfiguration() - Method in interface javax.robotics.engine.robots.Robot
Gets the robot configuration.
getRobotID() - Method in class javax.robotics.engine.controllers.ComputedTorque
 
getRobotID() - Method in interface javax.robotics.engine.controllers.Controller
Gets Robot class ID linked to controller.
getRobotID() - Method in class javax.robotics.engine.controllers.GravityCompensation
 
getRobotID() - Method in class javax.robotics.engine.controllers.ImpedanceControl
 
getRobotID() - Method in class javax.robotics.engine.controllers.PDGravityCompensation
 
getRobotID() - Method in class javax.robotics.engine.controllers.ProportionalDerivative
 
getRobotID() - Method in class javax.robotics.engine.controllers.ResolvedRateAcceleration
 
getRobotID() - Method in class javax.robotics.engine.controllers.RobustControl
 
getRobotPanel() - Method in class javax.robotics.simulator.CLIKRSimulation
 
getRobotPanel() - Method in class javax.robotics.simulator.CLIKSimulation
 
getRobotPanel() - Method in class javax.robotics.simulator.EndEffControlSimulation
 
getRobotPanel() - Method in class javax.robotics.simulator.JointControlSimulation
 
getS() - Method in class javax.robotics.vecmath.jama.SingularValueDecomposition
Return the diagonal matrix of singular values
getSampleTime() - Method in interface javax.robotics.engine.clik.CLIK
Gets the sample time.
getSampleTime() - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Gets the sample time.
getSampleTime() - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
getSampleTime() - Method in interface javax.robotics.engine.clik.CLIKR
Gets the sample time.
getSampleTime() - Method in class javax.robotics.ode.Euler
 
getSampleTime() - Method in class javax.robotics.ode.Euler2
 
getSampleTime() - Method in interface javax.robotics.ode.Solver
Gets the interval of integration.
getSampleTime() - Method in interface javax.robotics.ode.Solver2
Gets the interval of integration.
getScalar() - Method in class javax.robotics.vecmath.Quaternion
Gets the scalar component of Quaternion.
getSimpleUniverse() - Method in class javax.robotics.swing.RobotFrame
Gets the SimpleUniverse object so that you can add to it your own scene 3D.
getSimpleUniverse() - Method in class javax.robotics.swing.RobotPanel
Gets the SimpleUniverse object so that you can add to it your own scene 3D.
getSingularValues() - Method in class javax.robotics.vecmath.jama.SingularValueDecomposition
Return the one-dimensional array of singular values
getStepSize() - Method in class javax.robotics.swing.JointSpinnerPanel
Gets the minimum step of spinners.
getStepSize() - Method in class javax.robotics.swing.TipPanel
Gets the minimum step of spinners.
getSubMatrix(int, int, int, int, Matrix) - Method in class javax.robotics.vecmath.Matrix
Gets sub matrix from this Matrix.
getTeta() - Method in class javax.robotics.xml.XmlRobot
Gets the DH parameters θ.
getTime() - Method in class javax.robotics.ode.Euler
 
getTime() - Method in class javax.robotics.ode.Euler2
 
getTime() - Method in interface javax.robotics.ode.Solver
Gets current time of integration.
getTime() - Method in interface javax.robotics.ode.Solver2
Gets current time of integration.
getTipPanel() - Method in class javax.robotics.swing.KinematicsPanel
Gets the tip (end effector) command panel.
getTransformMatrix(int) - Method in class javax.robotics.engine.robots.DHRobot3D
Gets the 4x4 transformation matrix of i-th joint.
getTransformMatrix(int) - Method in interface javax.robotics.engine.robots.Robot3D
Gets the 4x4 transformation matrix of i-th joint.
getType() - Method in class javax.robotics.xml.XmlRobot
Gets the joint type flags.
getU() - Method in class javax.robotics.vecmath.jama.LUDecomposition
Return upper triangular factor
getU() - Method in class javax.robotics.vecmath.jama.SingularValueDecomposition
Return the left singular vectors
getURI() - Method in class javax.robotics.xml.XmlFileChooser
Gets the file URI.
getV() - Method in class javax.robotics.vecmath.jama.EigenvalueDecomposition
Return the eigenvector matrix
getV() - Method in class javax.robotics.vecmath.jama.SingularValueDecomposition
Return the right singular vectors
getValue() - Method in class javax.robotics.swing.JointSliderPanel
Gets the value of sliders.
getValue() - Method in class javax.robotics.swing.JointSpinnerPanel
Gets the value of spinners.
getVector() - Method in class javax.robotics.vecmath.Quaternion
Gets the vectorial component of Quaternion
getXmlHandler() - Method in class javax.robotics.engine.trajectory.Spline
Gets the xml confguration handler of trajectory.
getXmlHandler() - Method in interface javax.robotics.engine.trajectory.Trajectory
Gets the xml confguration handler of trajectory.
getXmlHandler() - Method in class javax.robotics.engine.trajectory.Trapezoidal
Gets the xml confguration handler of trajectory.
getXmlHandler() - Method in class javax.robotics.xml.XmlRobot
Gets the handle of xml configuration file.
getXmlHandler() - Method in class javax.robotics.xml.XmlSpline
Gets the handle of xml configuration file.
getXmlHandler() - Method in class javax.robotics.xml.XmlTrapezoidal
Gets the handle of xml configuration file.
GravityCompensation - Class in javax.robotics.engine.controllers
This class implements position controller with gravity compensation.
GravityCompensation(Robot, double, double, double, double) - Constructor for class javax.robotics.engine.controllers.GravityCompensation
Gravity compensation controller class constructor.
GravityCompensation(Robot, double, double) - Constructor for class javax.robotics.engine.controllers.GravityCompensation
Gravity compensation controller class constructor with positional jacobian.
GravityPanel - Class in javax.robotics.swing
This class creates a panel to set the gravity vector.
GravityPanel(Robot) - Constructor for class javax.robotics.swing.GravityPanel
The panel constructor
GREEN - Static variable in interface javax.robotics.j3d.ColorConstants
 

H

hasOrientation() - Method in class javax.robotics.xml.XmlSpline
Gets tag orientation of the file.
Heun - Class in javax.robotics.ode
This class implements Heun integration method.
Heun(double, RVector, DerivableFunction) - Constructor for class javax.robotics.ode.Heun
Defines numerical integration for x' = f(x) differential equation.
HOMOGENEOUS_MATRIX_DIM - Static variable in interface javax.robotics.engine.robots.Robot
 
hypot(double, double) - Static method in class javax.robotics.vecmath.jama.util.Maths
sqrt(a^2 + b^2) without under/overflow.

I

ID - Static variable in class javax.robotics.engine.JRoboOp
 
ImageDisplayer - Class in javax.robotics.image
Utility class to display buffered images.
ImageDisplayer(BufferedImage, String) - Constructor for class javax.robotics.image.ImageDisplayer
 
ImageFileChooser - Class in javax.robotics.image
Dialog panel to select xml configuration file.
ImageFileChooser() - Constructor for class javax.robotics.image.ImageFileChooser
Constructs a ImageFileChooser pointing to the user's default directory.
ImageFileChooser(String) - Constructor for class javax.robotics.image.ImageFileChooser
Constructs a ImageFileChooser using the given path.
ImageFileChooser(File) - Constructor for class javax.robotics.image.ImageFileChooser
Constructs a ImageFileChooser using the given File as the path.
ImageFileChooser(File, FileSystemView) - Constructor for class javax.robotics.image.ImageFileChooser
Constructs a ImageFileChooser using the given current directory and FileSystemView.
ImageFileChooser(String, FileSystemView) - Constructor for class javax.robotics.image.ImageFileChooser
Constructs a ImageFileChooser using the given current directory and FileSystemView.
ImageFileFilter - Class in javax.robotics.image
 
ImageFileFilter() - Constructor for class javax.robotics.image.ImageFileFilter
 
ImpedanceControl - Class in javax.robotics.engine.controllers
This class implements Impedance position controller.
ImpedanceControl(Robot, double[], double[], double[], double[], double[], double[], double[]) - Constructor for class javax.robotics.engine.controllers.ImpedanceControl
Impedance controller class constructor.
impedanceControl(short, short, double[], double[], double[], double[], double[], double[], double[], double[], double) - Method in class javax.robotics.engine.JRoboOp
 
inertia(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the inertia matrix.
inertia(RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
inertia(RVector) - Method in interface javax.robotics.engine.robots.Robot
Computes the inertia matrix.
initialize() - Method in class javax.robotics.j3d.CollisionDetector
 
initialize() - Method in class javax.robotics.simulator.CLIKRSimulation
 
initialize() - Method in class javax.robotics.simulator.CLIKSimulation
 
initialize() - Method in class javax.robotics.simulator.ClikWithConstraintSimulation
 
initialize() - Method in class javax.robotics.simulator.EndEffControlSimulation
 
initialize() - Method in class javax.robotics.simulator.EndEffPosControlSimulation
 
initialize() - Method in class javax.robotics.simulator.JointControlSimulation
 
INITMOTOR_DIM - Static variable in interface javax.robotics.engine.robots.Robot
 
INITROBOT_DIM - Static variable in interface javax.robotics.engine.robots.Robot
 
interpolate(short, double) - Method in class javax.robotics.engine.JRoboOp
Interpolates the spline at time t to set the position, velocity and acceleration.
interpolate(double, RVector, RVector, RVector) - Method in class javax.robotics.engine.trajectory.Spline
Interpolates the spline at time t to set the position, velocity and acceleration.
interpolate(double, RVector3d, RVector3d, RVector3d) - Method in class javax.robotics.engine.trajectory.Spline
Interpolates the spline at time t to set the position, velocity and acceleration.
interpolate(double, Quaternion, RVector3d) - Method in class javax.robotics.engine.trajectory.Spline
Interpolates the spline at time t to set the quaternion and angular velocity.
interpolate(double, RVector3d, RVector3d, RVector3d, Quaternion, RVector3d) - Method in class javax.robotics.engine.trajectory.Spline
Interpolates the spline at time t to set the position, velocity, acceleration, the quaternion and angular velocity.
interpolate(double) - Method in class javax.robotics.engine.trajectory.Spline
Deprecated.  
interpolate(double, RVector3d, RVector3d, RVector3d, Quaternion, RVector3d, RVector3d) - Method in class javax.robotics.engine.trajectory.Spline
Deprecated.  
interpolate(double, RVector, RVector, RVector) - Method in interface javax.robotics.engine.trajectory.Trajectory
Interpolates at time t to set the position, velocity and acceleration.
interpolate(double, RVector3d, RVector3d, RVector3d) - Method in interface javax.robotics.engine.trajectory.Trajectory
Interpolates at time t to set the position, velocity and acceleration.
interpolate(double, Quaternion, RVector3d) - Method in interface javax.robotics.engine.trajectory.Trajectory
Interpolates at time t to set the quaternion and angular velocity.
interpolate(double, RVector3d, RVector3d, RVector3d, Quaternion, RVector3d) - Method in interface javax.robotics.engine.trajectory.Trajectory
Interpolates at time t to set the position, velocity, acceleration, the quaternion and angular velocity.
interpolate(double, RVector3d, RVector3d, RVector3d, Quaternion, RVector3d, RVector3d) - Method in interface javax.robotics.engine.trajectory.Trajectory
Interpolates at time t to set the position, velocity, acceleration, the quaternion and angular velocity.
interpolate(double) - Method in interface javax.robotics.engine.trajectory.Trajectory
Interpolates at time t to set the position, velocity and acceleration.
interpolate(double, RVector, RVector, RVector) - Method in class javax.robotics.engine.trajectory.Trapezoidal
 
interpolate(double, RVector3d, RVector3d, RVector3d) - Method in class javax.robotics.engine.trajectory.Trapezoidal
 
interpolate(double) - Method in class javax.robotics.engine.trajectory.Trapezoidal
 
interpolate(double, Quaternion, RVector3d) - Method in class javax.robotics.engine.trajectory.Trapezoidal
Deprecated.  
interpolate(double, RVector3d, RVector3d, RVector3d, Quaternion, RVector3d) - Method in class javax.robotics.engine.trajectory.Trapezoidal
Deprecated.  
interpolate(double, RVector3d, RVector3d, RVector3d, Quaternion, RVector3d, RVector3d) - Method in class javax.robotics.engine.trajectory.Trapezoidal
Deprecated.  
interpolatePathQuat(short, double) - Method in class javax.robotics.engine.JRoboOp
Interpolates the spline at time t to set the position, velocity, acceleration, the quaternion and angular velocity.
interpolateQuat(short, double) - Method in class javax.robotics.engine.JRoboOp
Interpolates the spline at time t to set the quaternion and angular velocity.
inverse(double, double) - Method in class javax.robotics.vecmath.Matrix
Computes Damped Least Square inverse of this matrix using SVD decomposition.
inverse() - Method in class javax.robotics.vecmath.Matrix
Computes inverse or pseudoinverse of this matrix
invert() - Method in class javax.robotics.vecmath.DMatrix
Invert diagonal matrix in place.
invKine(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the solution of the Inverse Kinematics Problem from homogeneous transform matrix using a Newton-Raphson technique.
invKine(short, double[], int, int) - Method in class javax.robotics.engine.JRoboOp
Computes the solution of the Inverse Kinematics Problem from homogeneous transform matrix using a Newton-Raphson or Taylor expansion techniques.
invKine(RMatrix4d) - Method in class javax.robotics.engine.robots.DHRobot
 
invKine(RMatrix4d, int, int) - Method in class javax.robotics.engine.robots.DHRobot
 
invKine(RMatrix4d) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Inverse Kinematics Problem from homogeneous transform matrix using a Newton-Raphson technique.
invKine(RMatrix4d, int, int) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Inverse Kinematics Problem from homogeneous transform matrix using a Newton-Raphson or Taylor expansion techniques.
isDynamicsSet() - Method in class javax.robotics.xml.XmlRobot
Gets the tag dynamics of file.
isFullRank() - Method in class javax.robotics.vecmath.jama.QRDecomposition
Is the matrix full rank?
isJointImmobile(int) - Method in class javax.robotics.engine.robots.DHRobot3D
 
isJointImmobile(int) - Method in interface javax.robotics.engine.robots.Robot3D
Gets the immobile flag.
isJointPrismatic(int) - Method in class javax.robotics.engine.robots.DHRobot3D
 
isJointPrismatic(int) - Method in interface javax.robotics.engine.robots.Robot3D
Gets the type of joint REVOLUTE or PRISMATIC
isMotorSet() - Method in class javax.robotics.xml.XmlRobot
Gets the tag motor of file.
isNonsingular() - Method in class javax.robotics.vecmath.jama.LUDecomposition
Is the matrix nonsingular?
isOrientationSet() - Method in class javax.robotics.xml.XmlTrapezoidal
Gets tag orientation of the file.
isSPD() - Method in class javax.robotics.vecmath.jama.CholeskyDecomposition
Is the matrix symmetric and positive definite?
isSymmetric() - Method in class javax.robotics.vecmath.Matrix
Check if this matrix is symmetric

J

jacobian(short) - Method in class javax.robotics.engine.JRoboOp
Computes the Jacobian matrix expressed in the base frame.
jacobian(short, int) - Method in class javax.robotics.engine.JRoboOp
Computes the Jacobian matrix expressed in the ref-th frame.
jacobian() - Method in class javax.robotics.engine.robots.DHRobot
 
jacobian(int) - Method in class javax.robotics.engine.robots.DHRobot
 
jacobian() - Method in interface javax.robotics.engine.robots.Robot
Computes the Jacobian matrix expressed in the base frame.
jacobian(int) - Method in interface javax.robotics.engine.robots.Robot
Computes the Jacobian matrix expressed in the ref-th frame.
JACOBIAN_DIMENSION - Static variable in interface javax.robotics.engine.robots.Robot
 
jacobianDLSinv(short, double, double) - Method in class javax.robotics.engine.JRoboOp
Computes the 6x6 inverse Jacobian matrix based on the Damped Least-Squares scheme.
jacobianDLSinv(double, double) - Method in class javax.robotics.engine.robots.DHRobot
 
jacobianDLSinv(double, double) - Method in interface javax.robotics.engine.robots.Robot
Computes the 6x6 inverse Jacobian matrix based on the Damped Least-Squares scheme.
jacobianDot(short) - Method in class javax.robotics.engine.JRoboOp
Computes the Jacobian time derivative matrix expressed in the base frame.
jacobianDot(short, int) - Method in class javax.robotics.engine.JRoboOp
Computes the Jacobian time derivative matrix expressed in the ref-th frame.
jacobianDot() - Method in class javax.robotics.engine.robots.DHRobot
 
jacobianDot(int) - Method in class javax.robotics.engine.robots.DHRobot
 
jacobianDot() - Method in interface javax.robotics.engine.robots.Robot
Computes the Jacobian time derivative matrix expressed in the base frame.
jacobianDot(int) - Method in interface javax.robotics.engine.robots.Robot
Computes the Jacobian time derivative matrix expressed in the ref-th frame.
JacobianPanel - Class in javax.robotics.swing
This class creates a panel for robot jacobian calculation.
JacobianPanel(Robot) - Constructor for class javax.robotics.swing.JacobianPanel
The constructor of the panel.
javax.robotics.engine - package javax.robotics.engine
 
javax.robotics.engine.clik - package javax.robotics.engine.clik
 
javax.robotics.engine.controllers - package javax.robotics.engine.controllers
 
javax.robotics.engine.robots - package javax.robotics.engine.robots
 
javax.robotics.engine.trajectory - package javax.robotics.engine.trajectory
 
javax.robotics.image - package javax.robotics.image
 
javax.robotics.j3d - package javax.robotics.j3d
 
javax.robotics.ode - package javax.robotics.ode
 
javax.robotics.plot - package javax.robotics.plot
 
javax.robotics.simulator - package javax.robotics.simulator
 
javax.robotics.swing - package javax.robotics.swing
 
javax.robotics.util - package javax.robotics.util
 
javax.robotics.vecmath - package javax.robotics.vecmath
 
javax.robotics.vecmath.jama - package javax.robotics.vecmath.jama
 
javax.robotics.vecmath.jama.util - package javax.robotics.vecmath.jama.util
 
javax.robotics.xml - package javax.robotics.xml
 
JointController - Interface in javax.robotics.engine.controllers
Interface for different schemes of robot joints position controller.
JointControlSimulation - Class in javax.robotics.simulator
 
JointControlSimulation(Robot3D, JointController, Solver2, Trajectory, int) - Constructor for class javax.robotics.simulator.JointControlSimulation
 
JointSliderPanel - Class in javax.robotics.swing
This class creates a panel of sliders to move the joints of Robot3D.
JointSliderPanel(Robot3D) - Constructor for class javax.robotics.swing.JointSliderPanel
Creates the panel of sliders.
JointSpinnerPanel - Class in javax.robotics.swing
This class creates a panel of spinners to move the joints of Robot.
JointSpinnerPanel(Robot3D, double) - Constructor for class javax.robotics.swing.JointSpinnerPanel
Creates the panel of spinners.
JointStrokeConstraint - Class in javax.robotics.engine.clik
This class implements the constraint on joints stroke.
JointStrokeConstraint(double, RVector, RVector) - Constructor for class javax.robotics.engine.clik.JointStrokeConstraint
Define the constraint with minimum and maximum position for each joint and the constraint gain.
JRoboOp - Class in javax.robotics.engine
Java Robotics Oriented Package.
JRoboOp() - Constructor for class javax.robotics.engine.JRoboOp
Constructor of the engine.

K

keyPressed(KeyEvent) - Method in class javax.robotics.swing.RobotFrame
 
keyPressed(KeyEvent) - Method in class javax.robotics.swing.RobotPanel
 
keyReleased(KeyEvent) - Method in class javax.robotics.swing.RobotFrame
 
keyReleased(KeyEvent) - Method in class javax.robotics.swing.RobotPanel
 
keyTyped(KeyEvent) - Method in class javax.robotics.swing.RobotFrame
 
keyTyped(KeyEvent) - Method in class javax.robotics.swing.RobotPanel
 
kine(short) - Method in class javax.robotics.engine.JRoboOp
Computes the solution of the Forward Kinematics Problem.
kine(short, int) - Method in class javax.robotics.engine.JRoboOp
Computes the solution of the Forward Kinematics Problem for the link j.
kine() - Method in class javax.robotics.engine.robots.DHRobot
 
kine(int) - Method in class javax.robotics.engine.robots.DHRobot
 
kine() - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Forward Kinematics Problem.
kine(int) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Forward Kinematics Problem for the link j.
KinematicsPanel - Class in javax.robotics.swing
This class creates a panel with spinner for dir/inv kinematics.
KinematicsPanel(Robot3D) - Constructor for class javax.robotics.swing.KinematicsPanel
Constructor of the panel.
KinematicsPanel(Robot3D, double) - Constructor for class javax.robotics.swing.KinematicsPanel
Constructor of the panel.

L

Lights - Class in javax.robotics.j3d
This class creates a system of lights to add a 3D scene.
Lights() - Constructor for class javax.robotics.j3d.Lights
Composes an ambient light and three directional lights.
LookAndFeelSelector - Class in javax.robotics.swing
 
LookAndFeelSelector() - Constructor for class javax.robotics.swing.LookAndFeelSelector
 
LUDecomposition - Class in javax.robotics.vecmath.jama
LU Decomposition.
LUDecomposition(double[][], int, int) - Constructor for class javax.robotics.vecmath.jama.LUDecomposition
LU Decomposition
lyap(Matrix) - Method in class javax.robotics.vecmath.Matrix
Computes the solution of Lyapunov equation using eigenvalue decomposition.

M

MAGENTA - Static variable in interface javax.robotics.j3d.ColorConstants
 
Maths - Class in javax.robotics.vecmath.jama.util
 
Maths() - Constructor for class javax.robotics.vecmath.jama.util.Maths
 
Matrix - Class in javax.robotics.vecmath
A double precision, general, dynamically-resizable, two-dimensional matrix class.
Matrix(GMatrix) - Constructor for class javax.robotics.vecmath.Matrix
Constructs a new matrix with the same values as the GMatrix parameter.
Matrix(Matrix) - Constructor for class javax.robotics.vecmath.Matrix
Constructs a new matrix with the same values as the Matrix parameter.
Matrix(int) - Constructor for class javax.robotics.vecmath.Matrix
Constructs an n by n identity matrix.
Matrix(int, int) - Constructor for class javax.robotics.vecmath.Matrix
Constructs an nRow by NCol identity matrix.
Matrix(int, double[]) - Constructor for class javax.robotics.vecmath.Matrix
Constructs an n by n square matrix initialized to the values in the matrix array.
Matrix(int, int, double[]) - Constructor for class javax.robotics.vecmath.Matrix
Constructs an nRow by nCol matrix initialized to the values in the matrix array.
mul(Matrix) - Method in class javax.robotics.vecmath.DMatrix
Sets the value of return matrix to the result of multiplying this matrix with matrix M (this * M).
mul(DMatrix) - Method in class javax.robotics.vecmath.Matrix
Sets the value of this matrix to the result of multiplying itself with diagonal matrix D (this = this * D).
mul(DMatrix, RVector) - Method in class javax.robotics.vecmath.RVector
Multiplies diagonal matrix D times RVector v and places the result into this vector (this = D*v).
mul(RMatrix3d, RVector3d) - Method in class javax.robotics.vecmath.RVector3d
Multiplies matrix m times RVector v and places the result into this vector (this = m*v).
mul(DMatrix, RVector3d) - Method in class javax.robotics.vecmath.RVector3d
Multiplies diagonal matrix D times RVector v and places the result into this vector (this = D*v).
MultiPlot - Class in javax.robotics.plot
A flexible signal plotter.
MultiPlot() - Constructor for class javax.robotics.plot.MultiPlot
 
MultiPlot(String, String, String, String...) - Constructor for class javax.robotics.plot.MultiPlot
Constructor of plot graphics.
MultiPlotFrame - Class in javax.robotics.plot
Class to display multiple plot in a window.
MultiPlotFrame() - Constructor for class javax.robotics.plot.MultiPlotFrame
Default constructor of a 2x2 grid of plots.
MultiPlotFrame(String) - Constructor for class javax.robotics.plot.MultiPlotFrame
Constructor of a 2x2 grid of plots.
MultiPlotFrame(String, int, int) - Constructor for class javax.robotics.plot.MultiPlotFrame
Constructor of a plots grid with the specified number of rows and columns.
MultiPlotPanel - Class in javax.robotics.plot
Class to create multiple plot panel.
MultiPlotPanel() - Constructor for class javax.robotics.plot.MultiPlotPanel
Default constructor of a 2x2 grid of plots.
MultiPlotPanel(String) - Constructor for class javax.robotics.plot.MultiPlotPanel
Default constructor of a 2x2 grid of plots.
MultiPlotPanel(String, int, int) - Constructor for class javax.robotics.plot.MultiPlotPanel
Constructor of a plots grid with the specified number of rows and columns.

N

norm2() - Method in class javax.robotics.vecmath.jama.SingularValueDecomposition
Two norm
NOT_IN_RANGE - Static variable in interface javax.robotics.engine.trajectory.Trajectory
Error type about spline interpolation.

O

OffScreenCanvas3D - Class in javax.robotics.j3d
Java3D utility class to get a buffered image from a canvas 3D.
OffScreenCanvas3D(GraphicsConfiguration) - Constructor for class javax.robotics.j3d.OffScreenCanvas3D
 

P

PDGravityCompensation - Class in javax.robotics.engine.controllers
This class implements Proportional derivative with gravity compensation joints position controller.
PDGravityCompensation(Robot, double[], double[]) - Constructor for class javax.robotics.engine.controllers.PDGravityCompensation
Proportional Derivative with gravity compensation joints position controller class constructor.
PDGravityCompensation(Robot, DMatrix, DMatrix) - Constructor for class javax.robotics.engine.controllers.PDGravityCompensation
Proportional Derivative with gravity compensation joints position controller class constructor.
play() - Method in class javax.robotics.simulator.CLIKRSimulation
Plays the simulation.
play() - Method in class javax.robotics.simulator.CLIKSimulation
Plays the simulation.
play() - Method in class javax.robotics.simulator.EndEffControlSimulation
Plays the simulation.
play() - Method in class javax.robotics.simulator.JointControlSimulation
Plays the simulation.
png - Static variable in class javax.robotics.image.ImageFileFilter
 
postSwap() - Method in class javax.robotics.j3d.OffScreenCanvas3D
 
print(Graphics, PageFormat, int) - Method in class javax.robotics.plot.MultiPlotPanel
 
printf() - Method in class javax.robotics.vecmath.Matrix
Prints to standard out
printf(String) - Method in class javax.robotics.vecmath.Matrix
Prints to standard out according to the format string.
printf(PrintStream) - Method in class javax.robotics.vecmath.Matrix
Prints to PrintStream
printf(PrintStream, String) - Method in class javax.robotics.vecmath.Matrix
Prints to PrintStream according to the format string
printf() - Method in class javax.robotics.vecmath.Quaternion
Prints to standard out
printf(String) - Method in class javax.robotics.vecmath.Quaternion
Prints to standard out according to the format string.
printf(PrintStream) - Method in class javax.robotics.vecmath.Quaternion
Prints to PrintStream
printf(PrintStream, String) - Method in class javax.robotics.vecmath.Quaternion
Prints to PrintStream according to the format string
printf() - Method in class javax.robotics.vecmath.RMatrix3d
Prints to standard out
printf(String) - Method in class javax.robotics.vecmath.RMatrix3d
Prints to standard out according to the format string.
printf(PrintStream) - Method in class javax.robotics.vecmath.RMatrix3d
Prints to PrintStream
printf(PrintStream, String) - Method in class javax.robotics.vecmath.RMatrix3d
Prints to PrintStream according to the format string
printf() - Method in class javax.robotics.vecmath.RMatrix4d
Prints to standard out
printf(String) - Method in class javax.robotics.vecmath.RMatrix4d
Prints to standard out according to the format string.
printf(PrintStream) - Method in class javax.robotics.vecmath.RMatrix4d
Prints to PrintStream
printf(PrintStream, String) - Method in class javax.robotics.vecmath.RMatrix4d
Prints to PrintStream according to the format string
printf() - Method in class javax.robotics.vecmath.RVector
Prints to standard out
printf(String) - Method in class javax.robotics.vecmath.RVector
Prints to standard out according to the format string.
printf(PrintStream) - Method in class javax.robotics.vecmath.RVector
Prints to PrintStream
printf(PrintStream, String) - Method in class javax.robotics.vecmath.RVector
Prints to PrintStream according to the format string
printf() - Method in class javax.robotics.vecmath.RVector3d
Prints to standard out
printf(String) - Method in class javax.robotics.vecmath.RVector3d
Prints to standard out according to the format string.
printf(PrintStream) - Method in class javax.robotics.vecmath.RVector3d
Prints to PrintStream
printf(PrintStream, String) - Method in class javax.robotics.vecmath.RVector3d
Prints to PrintStream according to the format string
printf() - Method in class javax.robotics.vecmath.RVector4d
Prints to standard out
printf(String) - Method in class javax.robotics.vecmath.RVector4d
Prints to standard out according to the format string.
printf(PrintStream) - Method in class javax.robotics.vecmath.RVector4d
Prints to PrintStream
printf(PrintStream, String) - Method in class javax.robotics.vecmath.RVector4d
Prints to PrintStream according to the format string
PRISMATIC - Static variable in interface javax.robotics.engine.robots.Robot3D
 
processStimulus(Enumeration) - Method in class javax.robotics.j3d.CollisionDetector
 
processStimulus(Enumeration) - Method in class javax.robotics.simulator.CLIKRSimulation
 
processStimulus(Enumeration) - Method in class javax.robotics.simulator.CLIKSimulation
 
processStimulus(Enumeration) - Method in class javax.robotics.simulator.ClikWithConstraintSimulation
 
processStimulus(Enumeration) - Method in class javax.robotics.simulator.EndEffControlSimulation
 
processStimulus(Enumeration) - Method in class javax.robotics.simulator.EndEffPosControlSimulation
 
processStimulus(Enumeration) - Method in class javax.robotics.simulator.JointControlSimulation
 
ProportionalDerivative - Class in javax.robotics.engine.controllers
This class implements Proportional Derivative joints position controller.
ProportionalDerivative(Robot, double[], double[]) - Constructor for class javax.robotics.engine.controllers.ProportionalDerivative
Proportional Derivative joints position controller class constructor.
ProportionalDerivative(Robot, DMatrix, DMatrix) - Constructor for class javax.robotics.engine.controllers.ProportionalDerivative
Proportional Derivative joints position controller class constructor.
pseudoInverse() - Method in class javax.robotics.vecmath.Matrix
Computes pseudo inverse of this matrix using SVD decomposition.

Q

QRDecomposition - Class in javax.robotics.vecmath.jama
QR Decomposition.
QRDecomposition(double[][], int, int) - Constructor for class javax.robotics.vecmath.jama.QRDecomposition
QR Decomposition, computed by Householder reflections.
Quaternion - Class in javax.robotics.vecmath
A 4-element quaternion represented by double precision floating point x,y,z,w coordinates.
Quaternion() - Constructor for class javax.robotics.vecmath.Quaternion
Constructs and initializes a Quaternion to (0,0,0,0).
Quaternion(double[]) - Constructor for class javax.robotics.vecmath.Quaternion
Constructs and initializes a Quaternion from the array of length 4.
Quaternion(double, double, double, double) - Constructor for class javax.robotics.vecmath.Quaternion
Constructs and initializes a Quaternion from the specified xyzw coordinates.
Quaternion(Quat4d) - Constructor for class javax.robotics.vecmath.Quaternion
Constructs and initializes a Quaternion from the specified Quat4d.
Quaternion(Quaternion) - Constructor for class javax.robotics.vecmath.Quaternion
Constructs and initializes a new Quaternion from the specified Quaternion.

R

rank() - Method in class javax.robotics.vecmath.jama.SingularValueDecomposition
Effective numerical matrix rank
RED - Static variable in interface javax.robotics.j3d.ColorConstants
 
RemoteFile - Class in javax.robotics.util
Utility class to select a remote file.
RemoteFile(String) - Constructor for class javax.robotics.util.RemoteFile
Constructor from the url string.
RemoteFile(URL) - Constructor for class javax.robotics.util.RemoteFile
Constructor from the url.
resetPlots() - Method in class javax.robotics.plot.MultiPlotPanel
 
resetTime() - Method in class javax.robotics.ode.Euler2
 
resetTime() - Method in interface javax.robotics.ode.Solver2
Sets the current time to zero.
resetValue() - Method in class javax.robotics.swing.JointSliderPanel
Resets the value of sliders to zero.
resetValue() - Method in class javax.robotics.swing.JointSpinnerPanel
Sets the values of spinners to zero.
ResolvedRateAcceleration - Class in javax.robotics.engine.controllers
This class implements Resolved Rate Acceleration controller.
ResolvedRateAcceleration(Robot, double, double, double, double) - Constructor for class javax.robotics.engine.controllers.ResolvedRateAcceleration
Resolved Rate Acceleration controller class constructor.
ResolvedRateAcceleration(Robot, double, double) - Constructor for class javax.robotics.engine.controllers.ResolvedRateAcceleration
Resolved Rate Acceleration controller class constructor with positional jacobian.
REVOLUTE - Static variable in interface javax.robotics.engine.robots.Robot3D
 
RMatrix3d - Class in javax.robotics.vecmath
A double precision floating point 3 by 3 matrix.
RMatrix3d(Matrix3d) - Constructor for class javax.robotics.vecmath.RMatrix3d
Constructs a new matrix with the same values as the Matrix3d parameter.
RMatrix3d(RMatrix3d) - Constructor for class javax.robotics.vecmath.RMatrix3d
Constructs a new matrix with the same values as the RMatrix3d parameter.
RMatrix3d() - Constructor for class javax.robotics.vecmath.RMatrix3d
Constructs and initializes a RMatrix3d to all zeros.
RMatrix3d(double[]) - Constructor for class javax.robotics.vecmath.RMatrix3d
Constructs and initializes a RMatrix3d from the specified nine element array. this.m00=matrix[0], this.m01=matrix[1], ... , this.m10=matrix[3], etc.
RMatrix4d - Class in javax.robotics.vecmath
A double precision floating point 4 by 4 matrix.
RMatrix4d(Matrix4d) - Constructor for class javax.robotics.vecmath.RMatrix4d
Constructs a new matrix with the same values as the Matrix4d parameter.
RMatrix4d(RMatrix4d) - Constructor for class javax.robotics.vecmath.RMatrix4d
Constructs a new matrix with the same values as the RMatrix4d parameter.
RMatrix4d() - Constructor for class javax.robotics.vecmath.RMatrix4d
Constructs and initializes a Matrix4d to all zeros.
RMatrix4d(double[]) - Constructor for class javax.robotics.vecmath.RMatrix4d
Constructs and initializes a Matrix4d from the specified 16 element array. this.m00 =matrix[0], this.m01=matrix[1], ... , this.m10=matrix[4], etc.
RMatrix4d(RMatrix3d, RVector3d, double) - Constructor for class javax.robotics.vecmath.RMatrix4d
Constructs and initializes a RMatrix4f from the rotation matrix, translation, and scale values; the scale is applied only to the rotational components of the matrix (upper 3x3) and not to the translational components of the matrix.
RMatrix4d(Quaternion, RVector3d, double) - Constructor for class javax.robotics.vecmath.RMatrix4d
Constructs and initializes a RMatrix4d from the quaternion, translation, and scale values; the scale is applied only to the rotational components of the matrix (upper 3x3) and not to the translational components.
Robot - Interface in javax.robotics.engine.robots
This is an interface for kinematics and dynamics model of different open chain robot manipulators.
Robot3D - Interface in javax.robotics.engine.robots
This is an interface for graphic 3D, kinematics and dynamics model of different open chain robot manipulators.
Robot3DSceneGraph - Class in javax.robotics.j3d
Creates a default scene 3D with axes and lights.
Robot3DSceneGraph() - Constructor for class javax.robotics.j3d.Robot3DSceneGraph
 
Robot3DSceneGraph(Behavior) - Constructor for class javax.robotics.j3d.Robot3DSceneGraph
Creates a default scene 3D with axes and lights
RobotCanvas3D - Class in javax.robotics.j3d
Class to create a Java3D scene to display the robot.
RobotCanvas3D() - Constructor for class javax.robotics.j3d.RobotCanvas3D
Default constructor.
RobotCanvas3D(GraphicsConfiguration) - Constructor for class javax.robotics.j3d.RobotCanvas3D
Contructor with graphic configuration.
RobotFrame - Class in javax.robotics.swing
This class helps to embed Java3D scene and Robot3D in java windows.
RobotFrame() - Constructor for class javax.robotics.swing.RobotFrame
Constructor of a 600x600 Java3D window.
RobotFrame(String) - Constructor for class javax.robotics.swing.RobotFrame
Constructor of a 600x600 Java3D window.
RobotFrame(String, int, int) - Constructor for class javax.robotics.swing.RobotFrame
Constructor of a Java3D window.
RobotPanel - Class in javax.robotics.swing
This class helps to embed Java3D scene and Robot3D in java windows.
RobotPanel() - Constructor for class javax.robotics.swing.RobotPanel
Constructor of a 600x600 Java3D window.
RobotPanel(int, int) - Constructor for class javax.robotics.swing.RobotPanel
Constructor of a Java3D window.
RobustControl - Class in javax.robotics.engine.controllers
This class implements the Robust Control of joints position controller.
RobustControl(Robot, DMatrix, DMatrix, Matrix, double, double) - Constructor for class javax.robotics.engine.controllers.RobustControl
Robust control position controller class constructor.
RobustControl(Robot, DMatrix, DMatrix, Matrix, Matrix, double, double) - Constructor for class javax.robotics.engine.controllers.RobustControl
Robust control position controller class constructor with a pre-computed solution of Lyapunov equation.
RungeKutta4th - Class in javax.robotics.ode
This class implements RungeKutta4th integration method.
RungeKutta4th(double, RVector, DerivableFunction) - Constructor for class javax.robotics.ode.RungeKutta4th
Defines numerical integration RungeKutta4th for x' = f(x) differential equation.
RungeKutta4th2 - Class in javax.robotics.ode
This class implements forward RungeKutta4th integration method for systems of two first order differential equations.
RungeKutta4th2(double, RVector, RVector) - Constructor for class javax.robotics.ode.RungeKutta4th2
Defines RungeKutta4th numerical integration for x'' = f(x, x') as system of two first order differential equation.
RungeKutta4th2(double, RVector, RVector, DerivableFunction2) - Constructor for class javax.robotics.ode.RungeKutta4th2
Defines RungeKutta4th numerical integration for x'' = f(x, x') as system of two first order differential equation.
RVector - Class in javax.robotics.vecmath
A double precision, general, dynamically-resizable, one-dimensional vector class.
RVector(RVector) - Constructor for class javax.robotics.vecmath.RVector
Constructs a new RVector from the specified RVector.
RVector(RVector3d) - Constructor for class javax.robotics.vecmath.RVector
Constructs a new RVector from the specified RVector3d.
RVector(GVector) - Constructor for class javax.robotics.vecmath.RVector
Constructs a new RVector from the specified GVector.
RVector(double...) - Constructor for class javax.robotics.vecmath.RVector
Constructs a new RVector from the specified array elements.
RVector(double[], int) - Constructor for class javax.robotics.vecmath.RVector
Constructs a new RVector of the specified length and initializes it by copying the specified number of elements from the specified array.
RVector(int) - Constructor for class javax.robotics.vecmath.RVector
Constructs a new RVector of the specified length with all vector elements initialized to 0.
RVector3d - Class in javax.robotics.vecmath
A 3-element vector that is represented by double-precision floating point x,y,z coordinates.
RVector3d(RVector3d) - Constructor for class javax.robotics.vecmath.RVector3d
Constructs and initializes a RVector3d from the specified RVector3d.
RVector3d(Vector3d) - Constructor for class javax.robotics.vecmath.RVector3d
Constructs and initializes a RVector3d from the specified Vector3d.
RVector3d(double[]) - Constructor for class javax.robotics.vecmath.RVector3d
Constructs and initializes a RVector3d from the array of length 3.
RVector3d(double, double, double) - Constructor for class javax.robotics.vecmath.RVector3d
Constructs and initializes a RVector3d from the specified xyz coordinates.
RVector3d() - Constructor for class javax.robotics.vecmath.RVector3d
Constructs and initializes a RVector3d to (0,0,0).
RVector4d - Class in javax.robotics.vecmath
A 4-element vector represented by double-precision floating point x,y,z,w coordinates.
RVector4d() - Constructor for class javax.robotics.vecmath.RVector4d
Constructs and initializes a RVector4d to (0,0,0,0).
RVector4d(RVector4d) - Constructor for class javax.robotics.vecmath.RVector4d
Constructs and initializes a RVector4d from the specified RVector4d.
RVector4d(Vector4d) - Constructor for class javax.robotics.vecmath.RVector4d
Constructs and initializes a RVector4d from the specified Vector4d.
RVector4d(double[]) - Constructor for class javax.robotics.vecmath.RVector4d
Constructs and initializes a RVector4d from the coordinates contained in the array.
RVector4d(double, double, double, double) - Constructor for class javax.robotics.vecmath.RVector4d
Constructs and initializes a RVector4d from the specified xyzw coordinates.

S

S(RVector3d) - Method in class javax.robotics.vecmath.RMatrix3d
Gets S matrix.
ScreenImage - Class in javax.robotics.image
Utility class to capture buffered images from swing and AWT components.
ScreenImage() - Constructor for class javax.robotics.image.ScreenImage
 
SEMIDEFINITE_NEGATIVE - Static variable in class javax.robotics.vecmath.Matrix
Type of matrix.
SEMIDEFINITE_POSITIVE - Static variable in class javax.robotics.vecmath.Matrix
Type of matrix.
set(double[][]) - Method in class javax.robotics.vecmath.Matrix
Sets this matrix from bi-dimensional array
setDiagonal(RVector) - Method in class javax.robotics.vecmath.Matrix
Sets the diagonal of this matrix.
setEps(double) - Method in interface javax.robotics.engine.clik.CLIK
Sets the singular region area.
setEps(double) - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Sets the singular region area.
setEps(double) - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
setEps(double) - Method in interface javax.robotics.engine.clik.CLIKR
Sets the singular region area.
setFileName(String) - Method in class javax.robotics.image.ImageFileChooser
Gets the canonical name of the choosen file.
setGravity(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the gravity vector.
setGravity(RVector3d) - Method in class javax.robotics.engine.robots.DHRobot
 
setGravity(RVector3d) - Method in interface javax.robotics.engine.robots.Robot
Sets the gravity vector.
setGTK() - Static method in class javax.robotics.swing.LookAndFeelSelector
 
setInitialCondition(RVector) - Method in class javax.robotics.ode.Euler
 
setInitialCondition(RVector) - Method in interface javax.robotics.ode.Solver
Sets the initial condition for position x(0) = x0.
setInitialConditionPosition(RVector) - Method in class javax.robotics.ode.Euler2
 
setInitialConditionPosition(RVector) - Method in interface javax.robotics.ode.Solver2
Sets the initial condition for position x(0) = x0.
setInitialConditionVelocity(RVector) - Method in class javax.robotics.ode.Euler2
 
setInitialConditionVelocity(RVector) - Method in interface javax.robotics.ode.Solver2
Sets the initial condition for velocity x'(0) = y0.
setJavaDefault() - Static method in class javax.robotics.swing.LookAndFeelSelector
 
setK0(double) - Method in class javax.robotics.engine.clik.ConstraintFunction
 
setK0(double) - Method in interface javax.robotics.engine.clik.ConstraintVelocity
Sets the velocity constraint gain.
setK0(double) - Method in class javax.robotics.engine.clik.JointStrokeConstraint
 
setKd(DMatrix) - Method in class javax.robotics.engine.controllers.ComputedTorque
 
setKd(double[]) - Method in class javax.robotics.engine.controllers.ComputedTorque
Sets the velocity error gain matrix.
setKd(DMatrix) - Method in interface javax.robotics.engine.controllers.JointController
Sets the velocity error gain matrix.
setKd(double[]) - Method in class javax.robotics.engine.controllers.PDGravityCompensation
Sets the velocity error gain matrix.
setKd(DMatrix) - Method in class javax.robotics.engine.controllers.PDGravityCompensation
 
setKd(double[]) - Method in class javax.robotics.engine.controllers.ProportionalDerivative
Sets the velocity error gain matrix.
setKd(DMatrix) - Method in class javax.robotics.engine.controllers.ProportionalDerivative
 
setKd(DMatrix) - Method in class javax.robotics.engine.controllers.RobustControl
 
setKd(double[]) - Method in class javax.robotics.engine.controllers.RobustControl
Sets the velocity error gain matrix.
setKdCTM(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the position error gain matrix.
setKdPD(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the velocity error gain matrix.
setKdPDG(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the velocity error gain matrix.
setKdRC(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the position error gain matrix.
setKo(DMatrix) - Method in interface javax.robotics.engine.clik.CLIK
Sets the matrix of error orientation gain.
setKo(DMatrix) - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Sets the matrix of error orientation gain.
setKp(DMatrix) - Method in interface javax.robotics.engine.clik.CLIK
Sets the matrix of error position gain.
setKp(DMatrix) - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Sets the matrix of error position gain.
setKp(DMatrix) - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
setKp(DMatrix) - Method in interface javax.robotics.engine.clik.CLIKR
Sets the matrix of error position gain.
setKp(DMatrix) - Method in class javax.robotics.engine.controllers.ComputedTorque
 
setKp(double[]) - Method in class javax.robotics.engine.controllers.ComputedTorque
Sets the position error gain matrix.
setKp(DMatrix) - Method in interface javax.robotics.engine.controllers.JointController
Sets the position error gain matrix.
setKp(double[]) - Method in class javax.robotics.engine.controllers.PDGravityCompensation
Sets the position error gain matrix.
setKp(DMatrix) - Method in class javax.robotics.engine.controllers.PDGravityCompensation
 
setKp(double[]) - Method in class javax.robotics.engine.controllers.ProportionalDerivative
Sets the position error gain matrix.
setKp(DMatrix) - Method in class javax.robotics.engine.controllers.ProportionalDerivative
 
setKp(DMatrix) - Method in class javax.robotics.engine.controllers.RobustControl
 
setKp(double[]) - Method in class javax.robotics.engine.controllers.RobustControl
Sets the position error gain matrix.
setKpCTM(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the position error gain matrix.
setKpPD(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the position error gain matrix.
setKpPDG(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the position error gain matrix.
setKpRC(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the position error gain matrix.
setLambdaMax(double) - Method in interface javax.robotics.engine.clik.CLIK
Sets the maximum damped factor.
setLambdaMax(double) - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Sets the maximum damped factor.
setLambdaMax(double) - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
setLambdaMax(double) - Method in interface javax.robotics.engine.clik.CLIKR
Sets the maximum damped factor.
setMac() - Static method in class javax.robotics.swing.LookAndFeelSelector
 
setMotif() - Static method in class javax.robotics.swing.LookAndFeelSelector
 
setOnes() - Method in class javax.robotics.vecmath.Matrix
Sets all elements of this matrix to one
setQ(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets joints position adding the offset.
setQ(short, double, int) - Method in class javax.robotics.engine.JRoboOp
Sets i-th joint position adding the offset.
setQ(RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
setQ(double[]) - Method in class javax.robotics.engine.robots.DHRobot
 
setQ(double, int) - Method in class javax.robotics.engine.robots.DHRobot
 
setQ(RVector) - Method in interface javax.robotics.engine.robots.Robot
Sets joints position.
setQ(double[]) - Method in interface javax.robotics.engine.robots.Robot
Sets joints position.
setQ(double, int) - Method in interface javax.robotics.engine.robots.Robot
Sets the position pf i-th joint position.
setQ3D(RVector) - Method in class javax.robotics.engine.robots.DHRobot3D
 
setQ3D(double[]) - Method in class javax.robotics.engine.robots.DHRobot3D
 
setQ3D(double, int) - Method in class javax.robotics.engine.robots.DHRobot3D
 
setQ3D(RVector) - Method in interface javax.robotics.engine.robots.Robot3D
Sets the position of the joints.
setQ3D(double[]) - Method in interface javax.robotics.engine.robots.Robot3D
Sets the position of the joints.
setQ3D(double, int) - Method in interface javax.robotics.engine.robots.Robot3D
Sets the position of the i-th joint.
setQ3DOnly(RVector) - Method in class javax.robotics.engine.robots.DHRobot3D
 
setQ3DOnly(double[]) - Method in class javax.robotics.engine.robots.DHRobot3D
 
setQ3DOnly(double, int) - Method in class javax.robotics.engine.robots.DHRobot3D
 
setQ3DOnly(RVector) - Method in interface javax.robotics.engine.robots.Robot3D
Sets the position of the joints only of 3D model.
setQ3DOnly(double[]) - Method in interface javax.robotics.engine.robots.Robot3D
Sets the position of the joints only of 3D model.
setQ3DOnly(double, int) - Method in interface javax.robotics.engine.robots.Robot3D
Sets the position of the i-th joint only of 3D model.
setQp(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets joints velocity.
setQp(RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
setQp(double[]) - Method in class javax.robotics.engine.robots.DHRobot
 
setQp(RVector) - Method in interface javax.robotics.engine.robots.Robot
Sets joints velocity.
setQp(double[]) - Method in interface javax.robotics.engine.robots.Robot
Sets joints velocity.
setQpp(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets joints acceleration.
setQpp(RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
setQpp(double[]) - Method in class javax.robotics.engine.robots.DHRobot
 
setQpp(RVector) - Method in interface javax.robotics.engine.robots.Robot
Sets joints acceleration.
setQpp(double[]) - Method in interface javax.robotics.engine.robots.Robot
Sets joints acceleration.
setSampleTime(double) - Method in interface javax.robotics.engine.clik.CLIK
Sets the sample time.
setSampleTime(double) - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Sets the sample time.
setSampleTime(double) - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
 
setSampleTime(double) - Method in interface javax.robotics.engine.clik.CLIKR
Sets the sample time.
setSampleTime(double) - Method in class javax.robotics.ode.Euler
 
setSampleTime(double) - Method in class javax.robotics.ode.Euler2
 
setSampleTime(double) - Method in interface javax.robotics.ode.Solver
Sets the interval of integration.
setSampleTime(double) - Method in interface javax.robotics.ode.Solver2
Sets the interval of integration.
setSkin(InputStream) - Static method in class javax.robotics.swing.LookAndFeelSelector
 
setSkin(URL) - Static method in class javax.robotics.swing.LookAndFeelSelector
 
setSkin(String) - Static method in class javax.robotics.swing.LookAndFeelSelector
 
setTargetFunction(DerivableFunction2) - Method in class javax.robotics.ode.Euler2
 
setTargetFunction(DerivableFunction2) - Method in interface javax.robotics.ode.Solver2
Sets the target function to be integrated
setText(String) - Method in class javax.robotics.swing.DisplayPanel
Display the input text in the window.
setValue(RVector) - Method in class javax.robotics.swing.JointSliderPanel
Sets the value of sliders.
setValue(RVector) - Method in class javax.robotics.swing.JointSpinnerPanel
Sets the value of spinners.
setValues(double...) - Method in class javax.robotics.vecmath.RVector
Sets this vector from varargs input.
setWindows() - Static method in class javax.robotics.swing.LookAndFeelSelector
 
showButtons(boolean) - Method in class javax.robotics.plot.MultiPlotPanel
 
SingularValueDecomposition - Class in javax.robotics.vecmath.jama
Singular Value Decomposition.
SingularValueDecomposition(double[][], int, int) - Constructor for class javax.robotics.vecmath.jama.SingularValueDecomposition
Construct the singular value decomposition
solve(double[][], int) - Method in class javax.robotics.vecmath.jama.CholeskyDecomposition
Solve A*X = B
solve(double[][], int, int) - Method in class javax.robotics.vecmath.jama.LUDecomposition
Solve A*X = B
solve(double[][], int, int) - Method in class javax.robotics.vecmath.jama.QRDecomposition
Least squares solution of A*X = B
Solver - Interface in javax.robotics.ode
This class is an interface for differents numerical integration methods of first order differential equations.
Solver2 - Interface in javax.robotics.ode
This class is an interface for differents numerical integration methods of first order differential equations system.
SPACE_DIM - Static variable in interface javax.robotics.engine.robots.Robot
 
Spline - Class in javax.robotics.engine.trajectory
This class implements cubic spline interpolator.
Spline() - Constructor for class javax.robotics.engine.trajectory.Spline
Spline cubic path default constructor.
Spline(URI) - Constructor for class javax.robotics.engine.trajectory.Spline
Spline constructor with URI of xml file parameter.
Spline(File) - Constructor for class javax.robotics.engine.trajectory.Spline
Trajectory Spline Path constructor from XML file.
Spline(String) - Constructor for class javax.robotics.engine.trajectory.Spline
Trajectory Spline Path constructor from XML file.
Spline(InputStream) - Constructor for class javax.robotics.engine.trajectory.Spline
Trajectory Spline Path constructor from XML input stream.
split(RVector, RVector) - Method in class javax.robotics.vecmath.RVector
Splits this vector in two new vectors.
split(RVector, RVector, RVector) - Method in class javax.robotics.vecmath.RVector
Splits this vector in three new vectors.
splitColumns(RVector...) - Method in class javax.robotics.vecmath.Matrix
Splits columns of this matrix in multiple vectors.
splitColumns(double[]...) - Method in class javax.robotics.vecmath.Matrix
Splits columns of this matrix in multiple arrays.
splitRows(RVector...) - Method in class javax.robotics.vecmath.Matrix
Splits rows of this matrix in multiple vectors.
splitRows(double[]...) - Method in class javax.robotics.vecmath.Matrix
Splits rows of this matrix in multiple arrays.
start() - Method in class javax.robotics.simulator.CLIKRSimulation
Starts the simulation.
start() - Method in class javax.robotics.simulator.CLIKSimulation
Starts the simulation.
start() - Method in class javax.robotics.simulator.EndEffControlSimulation
Starts the simulation.
start() - Method in class javax.robotics.simulator.JointControlSimulation
Starts the simulation.
startTime - Static variable in interface javax.robotics.ode.Solver
 
startTime - Static variable in interface javax.robotics.ode.Solver2
 
stateChanged(ChangeEvent) - Method in class javax.robotics.swing.ExternalForcePanel
 
stateChanged(ChangeEvent) - Method in class javax.robotics.swing.GravityPanel
 
stateChanged(ChangeEvent) - Method in class javax.robotics.swing.JointSliderPanel
 
stateChanged(ChangeEvent) - Method in class javax.robotics.swing.JointSpinnerPanel
 
stateChanged(ChangeEvent) - Method in class javax.robotics.swing.TipPanel
 
step(RVector3d, RVector3d, Quaternion, RVector3d) - Method in interface javax.robotics.engine.clik.CLIK
Compute the joints position and velocity from a given desired end effector position and orientation.
step(RVector3d, RVector3d, Quaternion, RVector3d) - Method in class javax.robotics.engine.clik.ClikJacobianInverse
Compute the joints position and velocity from a given desired end effector position and orientation.
step(RVector, RVector) - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
Compute the joints position and velocity from a given desired end effector position and velocity.
step(RVector, RVector, ConstraintVelocity) - Method in class javax.robotics.engine.clik.ClikJacobianPosInverse
Compute the joints position and velocity from a given desired end effector position and velocity with velocity constraint.
step(RVector, RVector) - Method in class javax.robotics.engine.clik.ClikJacobianPosTranspose
Compute the joints position and velocity from a given desired end effector position and velocity.
step(RVector3d, RVector3d, Quaternion, RVector3d) - Method in class javax.robotics.engine.clik.ClikJacobianTranspose
Compute the joints position and velocity from a given desired end effector position and orientation.
step(RVector, RVector) - Method in interface javax.robotics.engine.clik.CLIKR
Compute the joints position and velocity from a given desired end effector position and velocity.
step(RVector, RVector, ConstraintVelocity) - Method in interface javax.robotics.engine.clik.CLIKR
Compute the joints position and velocity from a given desired end effector position and velocity with velocity constraints.
step(RVector) - Method in class javax.robotics.ode.Euler
 
step(RVector, RVector) - Method in class javax.robotics.ode.Euler2
 
step(RVector) - Method in class javax.robotics.ode.Heun
 
step(RVector) - Method in class javax.robotics.ode.RungeKutta4th
 
step(RVector, RVector) - Method in class javax.robotics.ode.RungeKutta4th2
 
step(RVector) - Method in interface javax.robotics.ode.Solver
Computes step integration from time t to t+dt of x' = f(x).
step(RVector, RVector) - Method in interface javax.robotics.ode.Solver2
Computes step integration from time t to t+dt of x'' = f(x, x').
stop() - Method in class javax.robotics.simulator.CLIKRSimulation
Stops the simulation.
stop() - Method in class javax.robotics.simulator.CLIKSimulation
Stops the simulation.
stop() - Method in class javax.robotics.simulator.EndEffControlSimulation
Stops the simulation.
stop() - Method in class javax.robotics.simulator.JointControlSimulation
Stops the simulation.
svd(RVector) - Method in class javax.robotics.vecmath.Matrix
Finds the singular value of this matrix.
svd(Matrix, Matrix, Matrix) - Method in class javax.robotics.vecmath.Matrix
Finds Singular Values Decomposition SVD of this matrix.

T

TipPanel - Class in javax.robotics.swing
This class creates a panel to set the position and the orientation of robot tip(end effector).
TipPanel(Robot3D, double) - Constructor for class javax.robotics.swing.TipPanel
Creates the panel of spinners for input forces and torques.
TOP - Static variable in class javax.robotics.j3d.Cylinder
Disegno con la parte superiore chiusa
TOP_BOTTOM - Static variable in class javax.robotics.j3d.Cylinder
Disegno con parte inferiore e parte superiore chiuse
torque(short, double[], double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the solution of the Inverse Dynamics Problem.
torque(short, double[], double[], double[], double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the solution of the Inverse Dynamics Problem with load applied to the last link.
torque(RVector, RVector, RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
torque(double[], double[], double[]) - Method in class javax.robotics.engine.robots.DHRobot
 
torque(RVector, RVector, RVector, RVector3d, RVector3d) - Method in class javax.robotics.engine.robots.DHRobot
 
torque(double[], double[], double[], double[], double[]) - Method in class javax.robotics.engine.robots.DHRobot
 
torque(RVector, RVector, RVector) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Inverse Dynamics Problem.
torque(double[], double[], double[]) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Inverse Dynamics Problem.
torque(RVector, RVector, RVector, RVector3d, RVector3d) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Inverse Dynamics Problem with load applied to the last link.
torque(double[], double[], double[], double[], double[]) - Method in interface javax.robotics.engine.robots.Robot
Computes the solution of the Inverse Dynamics Problem with load applied to the last link.
torqueC(RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
torqueC(RVector) - Method in interface javax.robotics.engine.robots.Robot
Computes the torques from the Coriolis and centrifugal effect.
torqueCmd(double[]...) - Method in class javax.robotics.engine.controllers.ComputedTorque
Sets the output torque for a desired joint position and velocity.
torqueCmd(RVector...) - Method in class javax.robotics.engine.controllers.ComputedTorque
Sets the output torque for a desired joint position and velocity.
torqueCmd(RVector3d, RVector3d, RVector3d, RVector3d, RVector3d, Quaternion) - Method in interface javax.robotics.engine.controllers.EndEffController
Sets the output torque for a desired end effector: acceleration, velocity, position, angular acceleration, angular velocity, angular position.
torqueCmd(RVector3d, RVector3d, RVector3d) - Method in interface javax.robotics.engine.controllers.EndEffController
Sets the output torque for a desired end effector: acceleration, velocity, position.
torqueCmd(double[], double[]) - Method in class javax.robotics.engine.controllers.GravityCompensation
Sets the output torque for a desired end effector position and angular position.
torqueCmd(RVector3d, Quaternion) - Method in class javax.robotics.engine.controllers.GravityCompensation
Sets the output torque for a desired end effector position and angular position.
torqueCmd(RVector3d) - Method in class javax.robotics.engine.controllers.GravityCompensation
Sets the output torque for a desired end effector position.
torqueCmd(RVector) - Method in class javax.robotics.engine.controllers.GravityCompensation
Sets the output torque for a desired end effector position.
torqueCmd(RVector3d, RVector3d, RVector3d, RVector3d, RVector3d, Quaternion) - Method in class javax.robotics.engine.controllers.GravityCompensation
Sets the output torque for a desired end effector position and angular position.
torqueCmd(RVector3d, RVector3d, RVector3d) - Method in class javax.robotics.engine.controllers.GravityCompensation
Sets the output torque for a desired end effector position.
torqueCmd(double[]...) - Method in interface javax.robotics.engine.controllers.JointController
Sets the output torque for a desired joint position and velocity and acceleration.
torqueCmd(RVector...) - Method in interface javax.robotics.engine.controllers.JointController
Sets the output torque for a desired joint position and velocity and acceleration.
torqueCmd(double[]...) - Method in class javax.robotics.engine.controllers.PDGravityCompensation
Sets the output torque for a desired joint position.
torqueCmd(RVector...) - Method in class javax.robotics.engine.controllers.PDGravityCompensation
Sets the output torque for a desired joint position and velocity.
torqueCmd(double[]...) - Method in class javax.robotics.engine.controllers.ProportionalDerivative
Sets the output torque for a desired joint position and velocity.
torqueCmd(RVector...) - Method in class javax.robotics.engine.controllers.ProportionalDerivative
Sets the output torque for a desired joint position and velocity.
torqueCmd(double[], double[], double[], double[], double[], double[]) - Method in class javax.robotics.engine.controllers.ResolvedRateAcceleration
Sets the output torque for a desired end effector: acceleration, velocity, position, angular acceleration, angular velocity, angular position.
torqueCmd(RVector3d, RVector3d, RVector3d, RVector3d, RVector3d, Quaternion) - Method in class javax.robotics.engine.controllers.ResolvedRateAcceleration
Sets the output torque for a desired end effector: acceleration, velocity, position, angular acceleration, angular velocity, angular position.
torqueCmd(RVector3d, RVector3d, RVector3d) - Method in class javax.robotics.engine.controllers.ResolvedRateAcceleration
Sets the output torque for a desired end effector: acceleration, velocity, position.
torqueCmd(double[]...) - Method in class javax.robotics.engine.controllers.RobustControl
Sets the output torque for a desired joint position and velocity.
torqueCmd(RVector...) - Method in class javax.robotics.engine.controllers.RobustControl
Sets the output torque for a desired joint position and velocity.
torqueCmdCTM(short, short, double[], double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the output torque for a desired joint position and velocity.
torqueCmdGCOMP(short, short, double[], double[], short) - Method in class javax.robotics.engine.JRoboOp
Sets the output torque for a desired end effector position and angular position.
torqueCmdGCOMP(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the output torque for a desired end effector position.
torqueCmdPD(short, short, double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the output torque for a desired joint position and velocity.
torqueCmdPDG(short, short, double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the output torque for a desired joint position and velocity.
torqueCmdRC(short, short, double[], double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the output torque for a desired joint position and velocity.
torqueCmdRRA(short, short, double[], double[], double[], double[], double[], double[], short) - Method in class javax.robotics.engine.JRoboOp
Sets the output torque for a desired end effector: acceleration, velocity, position, angular acceleration, angular velocity, angular position.
torqueCmdRRA(short, short, double[], double[], double[]) - Method in class javax.robotics.engine.JRoboOp
Sets the output torque for a desired end effector: acceleration, velocity, position.
torqueCoriolis(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the torques from the Coriolis and centrifugal effect.
torqueCoulombFriction(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the torques from the Coulomb friction.
torqueCoulombFriction(RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
torqueCoulombFriction(RVector) - Method in interface javax.robotics.engine.robots.Robot
Computes the torques from the Coulomb friction.
torqueGravity(short) - Method in class javax.robotics.engine.JRoboOp
Computes the torques from the gravity effect.
torqueGravity() - Method in class javax.robotics.engine.robots.DHRobot
 
torqueGravity() - Method in interface javax.robotics.engine.robots.Robot
Computes the torques from the gravity effect.
torqueViscousFriction(short, double[]) - Method in class javax.robotics.engine.JRoboOp
Computes the torques from the viscous friction.
torqueViscousFriction(RVector) - Method in class javax.robotics.engine.robots.DHRobot
 
torqueViscousFriction(RVector) - Method in interface javax.robotics.engine.robots.Robot
Computes the torques from the viscous friction.
toString() - Method in class javax.robotics.vecmath.Matrix
Returns a string that contains the values of this Matrix.
toString(String) - Method in class javax.robotics.vecmath.Matrix
Returns a string that contains the values of this Matrix, according to the format string
toString() - Method in class javax.robotics.vecmath.Quaternion
Returns a string that contains the values of this RVector.
toString(String) - Method in class javax.robotics.vecmath.Quaternion
Returns a string that contains the values of this RVector, according to the format string
toString() - Method in class javax.robotics.vecmath.RMatrix3d
Returns a string that contains the values of this RVector.
toString(String) - Method in class javax.robotics.vecmath.RMatrix3d
Returns a string that contains the values of this RVector, according to the format string
toString() - Method in class javax.robotics.vecmath.RMatrix4d
Returns a string that contains the values of this RVector.
toString(String) - Method in class javax.robotics.vecmath.RMatrix4d
Returns a string that contains the values of this RVector, according to the format string
toString() - Method in class javax.robotics.vecmath.RVector
Returns a string that contains the values of this RVector.
toString(String) - Method in class javax.robotics.vecmath.RVector
Returns a string that contains the values of this RVector, according to the format string
toString() - Method in class javax.robotics.vecmath.RVector3d
Returns a string that contains the values of this RVector.
toString(String) - Method in class javax.robotics.vecmath.RVector3d
Returns a string that contains the values of this RVector, according to the format string
toString() - Method in class javax.robotics.vecmath.RVector4d
Returns a string that contains the values of this RVector.
toString(String) - Method in class javax.robotics.vecmath.RVector4d
Returns a string that contains the values of this RVector, according to the format string
Trajectory - Interface in javax.robotics.engine.trajectory
This is an interface for different trajectory interpolators.
Trapezoidal - Class in javax.robotics.engine.trajectory
This class implements trapezoidal velocity profile interpolator.
Trapezoidal(URI) - Constructor for class javax.robotics.engine.trajectory.Trapezoidal
Constructor of trapezoidal interpolator with URI of xml file parameter.
Trapezoidal(String) - Constructor for class javax.robotics.engine.trajectory.Trapezoidal
Constructor of trapezoidal interpolator from XML file.
Trapezoidal(File) - Constructor for class javax.robotics.engine.trajectory.Trapezoidal
Constructor of trapezoidal interpolator from XML file.
Trapezoidal(InputStream) - Constructor for class javax.robotics.engine.trajectory.Trapezoidal
Constructor of trapezoidal interpolator from XML input stream.
Trapezoidal(RVector, RVector, RVector, double) - Constructor for class javax.robotics.engine.trajectory.Trapezoidal
Constructor of trapezoidal interpolator for trajectories of the same durations.
Trapezoidal(RVector, RVector, RVector, RVector) - Constructor for class javax.robotics.engine.trajectory.Trapezoidal
Constructor of trapezoidal interpolator for trajectories of differents durations.
Trapezoidal(double, double, double, double) - Constructor for class javax.robotics.engine.trajectory.Trapezoidal
Constructor of trapezoidal interpolator for a single trajectory.

U

updateValue() - Method in class javax.robotics.swing.JointSliderPanel
Updates the value of sliders to current robot position.
updateValue() - Method in class javax.robotics.swing.JointSpinnerPanel
Updates the values of spinners to current robot position.
updateValue() - Method in class javax.robotics.swing.TipPanel
Updates the panel values to the current robot tip position and orientation.

V

Version - Static variable in class javax.robotics.engine.JRoboOp
 

W

WHITE - Static variable in interface javax.robotics.j3d.ColorConstants
 
writeImage(BufferedImage, String) - Method in class javax.robotics.image.ScreenImage
Write a BufferedImage to a File.
WRONG_SIZE - Static variable in interface javax.robotics.engine.controllers.JointController
Incorrect size of error gain matrix

X

X - Static variable in class javax.robotics.j3d.Cylinder
Direzione X della generatrice del cilindro
xDot(RVector) - Method in interface javax.robotics.ode.DerivableFunction
Derivate prime function x' = f(x).
xDot(RVector) - Method in class javax.robotics.ode.Euler
 
xDot2(RVector, RVector) - Method in interface javax.robotics.ode.DerivableFunction2
Second order function x'' = f(x, x').
xDot2(RVector, RVector) - Method in class javax.robotics.ode.Euler2
 
xDot2(RVector, RVector) - Method in class javax.robotics.simulator.EndEffControlSimulation
 
xDot2(RVector, RVector) - Method in class javax.robotics.simulator.JointControlSimulation
 
XmlFileChooser - Class in javax.robotics.xml
Dialog panel to select xml configuration file.
XmlFileChooser() - Constructor for class javax.robotics.xml.XmlFileChooser
Constructs the chooser pointing to the user's default directory.
XmlFileChooser(String) - Constructor for class javax.robotics.xml.XmlFileChooser
Constructs the chooser from the given path.
XmlFileChooser(File) - Constructor for class javax.robotics.xml.XmlFileChooser
Constructs the chooser from a given File as the path.
XmlFileChooser(File, FileSystemView) - Constructor for class javax.robotics.xml.XmlFileChooser
Constructs the chooser using the given current directory and FileSystemView.
XmlFileChooser(String, FileSystemView) - Constructor for class javax.robotics.xml.XmlFileChooser
Constructs the chooser using the given current directory and FileSystemView.
XmlFileFilter - Class in javax.robotics.xml
Xml file extension filter.
XmlFileFilter() - Constructor for class javax.robotics.xml.XmlFileFilter
 
XmlRobot - Class in javax.robotics.xml
XML handler class for robot configuration file.
XmlRobot(String) - Constructor for class javax.robotics.xml.XmlRobot
Constructor of the xml handler.
XmlRobot(File) - Constructor for class javax.robotics.xml.XmlRobot
Constructor of the xml handler from file.
XmlRobot(InputStream) - Constructor for class javax.robotics.xml.XmlRobot
Constructor of the xml handler from input stream.
XmlSpline - Class in javax.robotics.xml
XML handler class for spline path configuration file.
XmlSpline(String) - Constructor for class javax.robotics.xml.XmlSpline
Constructor of the xml handler.
XmlSpline(File) - Constructor for class javax.robotics.xml.XmlSpline
Constructor of the xml handler.
XmlSpline(InputStream) - Constructor for class javax.robotics.xml.XmlSpline
Constructor of the xml handler.
XmlTrapezoidal - Class in javax.robotics.xml
XML handler class for trapezoida path configuration file.
XmlTrapezoidal(String) - Constructor for class javax.robotics.xml.XmlTrapezoidal
Constructor of the xml handler.
XmlTrapezoidal(File) - Constructor for class javax.robotics.xml.XmlTrapezoidal
Constructor of the xml handler.
XmlTrapezoidal(InputStream) - Constructor for class javax.robotics.xml.XmlTrapezoidal
Constructor of the xml handler.

Y

Y - Static variable in class javax.robotics.j3d.Cylinder
Direzione Y della generatrice del cilindro
YELLOW - Static variable in interface javax.robotics.j3d.ColorConstants
 

Z

Z - Static variable in class javax.robotics.j3d.Cylinder
Direzione Z della generatrice del cilindro

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