Serialized Form


Package com.yobotics.simulationconstructionset

Class com.yobotics.simulationconstructionset.BooleanYoVariable extends YoVariable implements Serializable

serialVersionUID: 3992114334565171154L

Serialized Fields

val

boolean val

Class com.yobotics.simulationconstructionset.CollisionIntegrator extends java.lang.Object implements Serializable

serialVersionUID: -6083539629185172597L

Serialized Fields

K

javax.vecmath.Matrix3d K

K_inv

javax.vecmath.Matrix3d K_inv

epsilon

double epsilon

mu

double mu

stableSticking

boolean stableSticking

amStuck

boolean amStuck

u0

javax.vecmath.Vector3d u0

Kx

javax.vecmath.Vector3d Kx

Ky

javax.vecmath.Vector3d Ky

Kz

javax.vecmath.Vector3d Kz

K_pseudo

javax.vecmath.Matrix3d K_pseudo

K_trans

javax.vecmath.Matrix3d K_trans

u_final

javax.vecmath.Vector3d u_final

delta_u

javax.vecmath.Vector3d delta_u

zeta_B

javax.vecmath.Vector3d zeta_B

pz_output

double[] pz_output

compression_output

double[] compression_output

restitution_output

double[] restitution_output

coeffs

double[] coeffs

solutions

double[] solutions

rootFinder

QuarticRootFinder rootFinder

collisionRungeKutta

CollisionRungeKutta collisionRungeKutta

pzRungeKutta

CollisionRungeKutta pzRungeKutta

rk_input

double[] rk_input

rk_range

double[] rk_range

pzDerivativeVector

com.yobotics.simulationconstructionset.CollisionIntegrator.PZDerivativeVector pzDerivativeVector

compressionDerivativeVector

com.yobotics.simulationconstructionset.CollisionIntegrator.CompressionDerivativeVector compressionDerivativeVector

restitutionDerivativeVector

com.yobotics.simulationconstructionset.CollisionIntegrator.RestitutionDerivativeVector restitutionDerivativeVector

zeta

javax.vecmath.Vector3d zeta

Class com.yobotics.simulationconstructionset.CollisionRungeKutta extends java.lang.Object implements Serializable

serialVersionUID: 8085611439415747376L

Serialized Fields

minStepSize_

double minStepSize_

stepSize_

double stepSize_

accuracy_

double accuracy_

currentStepSize_

double currentStepSize_

verbose

boolean verbose

adaptive_

boolean adaptive_

NVARS

int NVARS

nok

int[] nok

nbad

int[] nbad

dydx

double[] dydx

yend

double[] yend

yerr

double[] yerr

kmax

int kmax

kount

int kount

xp

double[] xp

yp

double[][] yp

dxsav

double dxsav

x

double[] x

hnext

double[] hnext

hdid

double[] hdid

yscal

double[] yscal

y

double[] y

ytemp

double[] ytemp

ak2

double[] ak2

ak3

double[] ak3

ak4

double[] ak4

ak5

double[] ak5

ak6

double[] ak6

ytemp2

double[] ytemp2

Class com.yobotics.simulationconstructionset.CylinderJoint extends PinJoint implements Serializable

serialVersionUID: -1979031212754263175L

Serialized Fields

joint2

SliderJoint joint2

Class com.yobotics.simulationconstructionset.DataBuffer extends YoVariableHolderImplementation implements Serializable

serialVersionUID: 6736812894819363756L

Serialized Fields

inPoint

int inPoint

index

int index

maxBufferSize

int maxBufferSize

outPoint

int outPoint

simulationRewoundListeners

java.util.ArrayList<E> simulationRewoundListeners

t

DoubleYoVariable t

yoVariableSet

java.util.LinkedHashSet<E> yoVariableSet

wrapBuffer

boolean wrapBuffer

keyPoints

KeyPoints keyPoints

dataBufferListeners

java.util.ArrayList<E> dataBufferListeners

bufferSize

int bufferSize

entries

java.util.ArrayList<E> entries

indexChangedListeners

java.util.ArrayList<E> indexChangedListeners

toggleKeyPointModeCommandListeners

java.util.ArrayList<E> toggleKeyPointModeCommandListeners

clearing

boolean clearing

Class com.yobotics.simulationconstructionset.DataBuffer.RepeatDataBufferEntryException extends java.lang.Exception implements Serializable

serialVersionUID: -8151095313463159788L

Class com.yobotics.simulationconstructionset.DoubleYoVariable extends YoVariable implements Serializable

serialVersionUID: 7478220484119778907L

Serialized Fields

val

double val

Class com.yobotics.simulationconstructionset.EnumYoVariable extends YoVariable implements Serializable

serialVersionUID: -7043358626008557981L

Serialized Fields

enumType

java.lang.Class<T> enumType

allowNullValue

boolean allowNullValue

val

java.lang.Enum<E extends java.lang.Enum<E>> val

Class com.yobotics.simulationconstructionset.ExternalForcePoint extends KinematicPoint implements Serializable

serialVersionUID: -7715587266631433612L

Serialized Fields

force

YoFrameVector force

impulse

YoFrameVector impulse

fx

DoubleYoVariable fx

fy

DoubleYoVariable fy

fz

DoubleYoVariable fz

px

DoubleYoVariable px

py

DoubleYoVariable py

pz

DoubleYoVariable pz

R0_coll

javax.vecmath.Matrix3d R0_coll

Rcoll_0

javax.vecmath.Matrix3d Rcoll_0

Rk_coll

javax.vecmath.Matrix3d Rk_coll

Rk_coll2

javax.vecmath.Matrix3d Rk_coll2

u_coll

javax.vecmath.Vector3d u_coll

Ki_collision_total

javax.vecmath.Matrix3d Ki_collision_total

zAxis

javax.vecmath.Vector3d zAxis

yAxis

javax.vecmath.Vector3d yAxis

xAxis

javax.vecmath.Vector3d xAxis

Class com.yobotics.simulationconstructionset.FloatingJoint extends Joint implements Serializable

serialVersionUID: 6863566500545068060L

Serialized Fields

k_qdd_x

double[] k_qdd_x

k_qdd_y

double[] k_qdd_y

k_qdd_z

double[] k_qdd_z

k_qdd_wx

double[] k_qdd_wx

k_qdd_wy

double[] k_qdd_wy

k_qdd_wz

double[] k_qdd_wz

k_qd_x

double[] k_qd_x

k_qd_y

double[] k_qd_y

k_qd_z

double[] k_qd_z

k_qd_wx

double[] k_qd_wx

k_qd_wy

double[] k_qd_wy

k_qd_wz

double[] k_qd_wz

k_qd_qs

double[] k_qd_qs

k_qd_qx

double[] k_qd_qx

k_qd_qy

double[] k_qd_qy

k_qd_qz

double[] k_qd_qz

tempOrientation1

javax.vecmath.Quat4d tempOrientation1

tempPosition1

javax.vecmath.Vector3d tempPosition1

tempOrientation2

javax.vecmath.Quat4d tempOrientation2

wXr1

javax.vecmath.Vector3d wXr1

a_hat_world_top

javax.vecmath.Vector3d a_hat_world_top

a_hat_world_bot

javax.vecmath.Vector3d a_hat_world_bot

a_hat_matrix

Matrix a_hat_matrix

Z_hat_matrix

Matrix Z_hat_matrix

Y_hat_matrix

Matrix Y_hat_matrix

I_hat_matrix

Matrix I_hat_matrix

wdXr

javax.vecmath.Vector3d wdXr

wXr

javax.vecmath.Vector3d wXr

wXwXr

javax.vecmath.Vector3d wXwXr

delta_qd_xyz

javax.vecmath.Vector3d delta_qd_xyz

I_hat_inverse

Matrix I_hat_inverse

q_x

DoubleYoVariable q_x

q_y

DoubleYoVariable q_y

q_z

DoubleYoVariable q_z

qd_x

DoubleYoVariable qd_x

qd_y

DoubleYoVariable qd_y

qd_z

DoubleYoVariable qd_z

q_qs

DoubleYoVariable q_qs

q_qx

DoubleYoVariable q_qx

q_qy

DoubleYoVariable q_qy

q_qz

DoubleYoVariable q_qz

qd_wx

DoubleYoVariable qd_wx

qd_wy

DoubleYoVariable qd_wy

qd_wz

DoubleYoVariable qd_wz

q_x_n

double q_x_n

q_y_n

double q_y_n

q_z_n

double q_z_n

qd_x_n

double qd_x_n

qd_y_n

double qd_y_n

qd_z_n

double qd_z_n

q_qs_n

double q_qs_n

q_qx_n

double q_qx_n

q_qy_n

double q_qy_n

q_qz_n

double q_qz_n

qd_wx_n

double qd_wx_n

qd_wy_n

double qd_wy_n

qd_wz_n

double qd_wz_n

qdd_x

DoubleYoVariable qdd_x

qdd_y

DoubleYoVariable qdd_y

qdd_z

DoubleYoVariable qdd_z

qdd_wx

DoubleYoVariable qdd_wx

qdd_wy

DoubleYoVariable qdd_wy

qdd_wz

DoubleYoVariable qdd_wz

Class com.yobotics.simulationconstructionset.FloatingPlanarJoint extends Joint implements Serializable

serialVersionUID: -1627814016079577790L

Serialized Fields

q_t1

DoubleYoVariable q_t1

q_t2

DoubleYoVariable q_t2

qd_t1

DoubleYoVariable qd_t1

qd_t2

DoubleYoVariable qd_t2

q_rot

DoubleYoVariable q_rot

qd_rot

DoubleYoVariable qd_rot

qdd_t1

DoubleYoVariable qdd_t1

qdd_t2

DoubleYoVariable qdd_t2

qdd_rot

DoubleYoVariable qdd_rot

type

int type

q_t1_n

double q_t1_n

q_t2_n

double q_t2_n

qd_t1_n

double qd_t1_n

qd_t2_n

double qd_t2_n

q_rot_n

double q_rot_n

qd_rot_n

double qd_rot_n

k_qdd_t1

double[] k_qdd_t1

k_qdd_t2

double[] k_qdd_t2

k_qd_t1

double[] k_qd_t1

k_qd_t2

double[] k_qd_t2

k_qdd_rot

double[] k_qdd_rot

k_qd_rot

double[] k_qd_rot

floatingJointVars

VarList floatingJointVars

position

javax.vecmath.Vector3d position

wdXr

javax.vecmath.Vector3d wdXr

wXr

javax.vecmath.Vector3d wXr

wXwXr

javax.vecmath.Vector3d wXwXr

delta_qd_xyz

javax.vecmath.Vector3d delta_qd_xyz

I_hat_matrix

Matrix I_hat_matrix

Z_hat_matrix

Matrix Z_hat_matrix

a_hat_matrix

Matrix a_hat_matrix

a_hat_world_bot

javax.vecmath.Vector3d a_hat_world_bot

Y_hat_matrix

Matrix Y_hat_matrix

I_hat_inverse

Matrix I_hat_inverse

Class com.yobotics.simulationconstructionset.FreeJoint extends Joint implements Serializable

serialVersionUID: 5257393793242028735L

Serialized Fields

xName

java.lang.String xName

yName

java.lang.String yName

zName

java.lang.String zName

yawName

java.lang.String yawName

rollName

java.lang.String rollName

pitchName

java.lang.String pitchName

xVar

DoubleYoVariable xVar

yVar

DoubleYoVariable yVar

zVar

DoubleYoVariable zVar

yawVar

DoubleYoVariable yawVar

rollVar

DoubleYoVariable rollVar

pitchVar

DoubleYoVariable pitchVar

vTranslate

javax.vecmath.Vector3d vTranslate

tYaw

javax.media.j3d.Transform3D tYaw

tRoll

javax.media.j3d.Transform3D tRoll

tPitch

javax.media.j3d.Transform3D tPitch

freeJointVars

VarList freeJointVars

Class com.yobotics.simulationconstructionset.GimbalJoint extends PinJoint implements Serializable

serialVersionUID: 6692640300004794312L

Serialized Fields

joint2

PinJoint joint2

joint3

PinJoint joint3

Class com.yobotics.simulationconstructionset.GroundContactPoint extends ExternalForcePoint implements Serializable

serialVersionUID: 2334921180229856021L

Serialized Fields

tdx

DoubleYoVariable tdx

tdy

DoubleYoVariable tdy

tdz

DoubleYoVariable tdz

fs

DoubleYoVariable fs

slip

BooleanYoVariable slip

coll

DoubleYoVariable coll

Class com.yobotics.simulationconstructionset.IntegerYoVariable extends YoVariable implements Serializable

serialVersionUID: -3169412792231273223L

Serialized Fields

val

int val

Class com.yobotics.simulationconstructionset.Joint extends java.lang.Object implements Serializable

serialVersionUID: -1158152164230922246L

Serialized Fields

parentJoint

Joint parentJoint

offset

javax.vecmath.Vector3d offset

u_i

javax.vecmath.Vector3d u_i

d_i

javax.vecmath.Vector3d d_i

u_iXd_i

javax.vecmath.Vector3d u_iXd_i

r_in

javax.vecmath.Vector3d r_in

w_i

javax.vecmath.Vector3d w_i

v_i

javax.vecmath.Vector3d v_i

r_i

javax.vecmath.Vector3d r_i

r_h

javax.vecmath.Vector3d r_h

v_i_temp

javax.vecmath.Vector3d v_i_temp

i_X_hat_h

SpatialTransformationMatrix i_X_hat_h

h_X_hat_i

SpatialTransformationMatrix h_X_hat_i

Z_hat_i

SpatialVector Z_hat_i

I_hat_i

SpatialInertiaMatrix I_hat_i

c_hat_i

SpatialVector c_hat_i

a_hat_i

SpatialVector a_hat_i

s_hat_i

SpatialVector s_hat_i

Q_i

double Q_i

transformToNext

javax.media.j3d.Transform3D transformToNext

link

Link link

name

java.lang.String name

offsetTransform3D

javax.media.j3d.Transform3D offsetTransform3D

jointTransform3D

javax.media.j3d.Transform3D jointTransform3D

numDOF

int numDOF

rob

Robot rob

childrenJoints

java.util.ArrayList<E> childrenJoints

cameraMounts

java.util.ArrayList<E> cameraMounts

imuMounts

java.util.ArrayList<E> imuMounts

kinematicPoints

java.util.ArrayList<E> kinematicPoints

externalForcePoints

java.util.ArrayList<E> externalForcePoints

groundContactPointGroups

java.util.LinkedHashMap<K,V> groundContactPointGroups

groundContactPointGroupList

java.util.ArrayList<E> groundContactPointGroupList

sensors

java.util.ArrayList<E> sensors

isDynamic

boolean isDynamic

tempVector3d

javax.vecmath.Vector3d tempVector3d

tempQuat4d

javax.vecmath.Quat4d tempQuat4d

Ri_0

javax.vecmath.Matrix3d Ri_0

R0_i

javax.vecmath.Matrix3d R0_i

Ri_h

javax.vecmath.Matrix3d Ri_h

Rh_i

javax.vecmath.Matrix3d Rh_i

Rtemp

javax.vecmath.Matrix3d Rtemp

externalForceVector

javax.vecmath.Vector3d externalForceVector

externalForceR

javax.vecmath.Vector3d externalForceR

externalMomentVector

javax.vecmath.Vector3d externalMomentVector

w_h

javax.vecmath.Vector3d w_h

sIs

double sIs

Qi_etc

double Qi_etc

SIM1

SpatialInertiaMatrix SIM1

SIM2

SpatialInertiaMatrix SIM2

sV1

SpatialVector sV1

sV2

SpatialVector sV2

X_hat_h_a_hat_h

SpatialVector X_hat_h_a_hat_h

qdd_s_hat_i

SpatialVector qdd_s_hat_i

tempDeltaPVector

javax.vecmath.Vector3d tempDeltaPVector

tempOmegaCrossDeltaPVector

javax.vecmath.Vector3d tempOmegaCrossDeltaPVector

tempOmegaCrossOmegaCrossDeltaPVector

javax.vecmath.Vector3d tempOmegaCrossOmegaCrossDeltaPVector

Ki

javax.vecmath.Matrix3d Ki

collisionIntegrator

CollisionIntegrator collisionIntegrator

p_hat_k

SpatialVector p_hat_k

k_X_hat_coll

SpatialTransformationMatrix k_X_hat_coll

goob

javax.vecmath.Vector3d goob

delta_v_hat_null

SpatialVector delta_v_hat_null

p_hat_coll

SpatialVector p_hat_coll

delta_v_hat_k

SpatialVector delta_v_hat_k

coll_X_hat_k

SpatialTransformationMatrix coll_X_hat_k

Y_hat_i

SpatialVector Y_hat_i

Y_hat_parent

SpatialVector Y_hat_parent

delta_v_hat_h

SpatialVector delta_v_hat_h

delta_v_temp1

SpatialVector delta_v_temp1

delta_v_temp2

SpatialVector delta_v_temp2

tempCOMPoint

javax.vecmath.Point3d tempCOMPoint

tempLinearMomentum

javax.vecmath.Vector3d tempLinearMomentum

tempAngularMomentum

javax.vecmath.Vector3d tempAngularMomentum

tempCOMVector

javax.vecmath.Vector3d tempCOMVector

tempRotationalEnergyVector

javax.vecmath.Vector3d tempRotationalEnergyVector

tempPE_COMPoint

javax.vecmath.Point3d tempPE_COMPoint

doFreezeFrame

boolean doFreezeFrame

Class com.yobotics.simulationconstructionset.KinematicPoint extends java.lang.Object implements Serializable

serialVersionUID: 3047881738704107434L

Serialized Fields

name

java.lang.String name

offset

javax.vecmath.Vector3d offset

temp

javax.vecmath.Point3d temp

position

YoFramePoint position

velocity

YoFrameVector velocity

offsetYoFrameVector

YoFrameVector offsetYoFrameVector

x

DoubleYoVariable x

y

DoubleYoVariable y

z

DoubleYoVariable z

dx

DoubleYoVariable dx

dy

DoubleYoVariable dy

dz

DoubleYoVariable dz

parentJoint

Joint parentJoint

rob

Robot rob

kinematicPointUpdater

KinematicPointUpdater kinematicPointUpdater

tempTransformFromWorldToJoint

javax.media.j3d.Transform3D tempTransformFromWorldToJoint

offsetPlus

javax.vecmath.Vector4d offsetPlus

offsetFromCOM

javax.vecmath.Vector3d offsetFromCOM

wXr

javax.vecmath.Vector3d wXr

v_point

javax.vecmath.Vector3d v_point

Class com.yobotics.simulationconstructionset.Link extends java.lang.Object implements Serializable

serialVersionUID: 5447931499263283994L

Serialized Fields

name

java.lang.String name

parentJoint

Joint parentJoint

mass

double mass

comOffset

javax.vecmath.Vector3d comOffset

Inertia

javax.vecmath.Matrix3d Inertia

linkGraphics

Graphics3DObject linkGraphics

polyTree

vclip.PolyTree polyTree

maxVelocity

double maxVelocity

ef_collision

ExternalForcePoint ef_collision

Class com.yobotics.simulationconstructionset.LongYoVariable extends YoVariable implements Serializable

serialVersionUID: 2042336747461370423L

Serialized Fields

val

long val

Class com.yobotics.simulationconstructionset.NameSpace extends java.lang.Object implements Serializable

serialVersionUID: -2584260031738121095L

Serialized Fields

name

java.lang.String name

subNames

java.util.ArrayList<E> subNames

Class com.yobotics.simulationconstructionset.NoisyDoubleYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: 8152020075993223818L

Serialized Fields

isNoisy

BooleanYoVariable isNoisy

useBias

BooleanYoVariable useBias

noiseType

EnumYoVariable<T extends java.lang.Enum<T>> noiseType

randomSeed

long randomSeed

rand

java.util.Random rand

randomBound

DoubleYoVariable randomBound

bias

DoubleYoVariable bias

biasMin

DoubleYoVariable biasMin

biasMax

DoubleYoVariable biasMax

biasDelta

DoubleYoVariable biasDelta

standardDeviation

DoubleYoVariable standardDeviation

perfect

DoubleYoVariable perfect

Class com.yobotics.simulationconstructionset.NullJoint extends Joint implements Serializable

serialVersionUID: 1341493615657008348L

Serialized Fields

hasLimitStops

boolean hasLimitStops

q_min

double q_min

q_max

double q_max

k_limit

double k_limit

b_limit

double b_limit

b_damp

double b_damp

hasVelocityLimits

boolean hasVelocityLimits

qd_max

double qd_max

b_vel_limit

double b_vel_limit

hasTorqueLimits

boolean hasTorqueLimits

tau_max

double tau_max

jointVars

VarList jointVars

axisAngle

javax.vecmath.AxisAngle4d axisAngle

Class com.yobotics.simulationconstructionset.OneDegreeOfFreedomJoint extends Joint implements Serializable

serialVersionUID: -462519687462777726L

Serialized Fields

kp

double kp

kd

double kd

qDesired

double qDesired

qdDesired

double qdDesired

Class com.yobotics.simulationconstructionset.PinJoint extends OneDegreeOfFreedomJoint implements Serializable

serialVersionUID: -8016564065453170730L

Serialized Fields

k_qdd

double[] k_qdd

k_qd

double[] k_qd

axisAngle

javax.vecmath.AxisAngle4d axisAngle

vel_iXd_i

javax.vecmath.Vector3d vel_iXd_i

w_hXr_i

javax.vecmath.Vector3d w_hXr_i

vel_i

javax.vecmath.Vector3d vel_i

temp1

javax.vecmath.Vector3d temp1

temp2

javax.vecmath.Vector3d temp2

temp3

javax.vecmath.Vector3d temp3

q

DoubleYoVariable q

qd

DoubleYoVariable qd

qdd

DoubleYoVariable qdd

tau

DoubleYoVariable tau

tauJointLimit

DoubleYoVariable tauJointLimit

tauVelocityLimit

DoubleYoVariable tauVelocityLimit

tauDamping

DoubleYoVariable tauDamping

q_min

double q_min

q_max

double q_max

k_limit

double k_limit

b_limit

double b_limit

b_damp

double b_damp

q_n

double q_n

qd_n

double qd_n

qd_max

DoubleYoVariable qd_max

b_vel_limit

DoubleYoVariable b_vel_limit

tau_max

DoubleYoVariable tau_max

torqueSpeedCurve

TorqueSpeedCurve torqueSpeedCurve

registry

YoVariableRegistry registry

Class com.yobotics.simulationconstructionset.Robot extends java.lang.Object implements Serializable

serialVersionUID: -2402598315911507793L

Serialized Fields

yoVariableRegistry

YoVariableRegistry yoVariableRegistry

dynamicGraphicObjectsListRegistries

java.util.ArrayList<E> dynamicGraphicObjectsListRegistries

rootJoints

java.util.ArrayList<E> rootJoints

functionIntegrators

FunctionIntegrators functionIntegrators

name

java.lang.String name

t

DoubleYoVariable t

gravityX

DoubleYoVariable gravityX

gravityY

DoubleYoVariable gravityY

gravityZ

DoubleYoVariable gravityZ

controllers

java.util.ArrayList<E> controllers

groundContactModel

GroundContactModel groundContactModel

kp_body

ExternalForcePoint kp_body

dynamicIntegrationMethod

DynamicIntegrationMethod dynamicIntegrationMethod

staticLinkGraphics

java.util.ArrayList<E> staticLinkGraphics

w_null

javax.vecmath.Vector3d w_null

v_null

javax.vecmath.Vector3d v_null

a_hat_h_null

SpatialVector a_hat_h_null

R_0_i

javax.vecmath.Matrix3d R_0_i

tempCOMPoint

javax.vecmath.Point3d tempCOMPoint

tempLinearMomentum

javax.vecmath.Vector3d tempLinearMomentum

tempAngularMomentum

javax.vecmath.Vector3d tempAngularMomentum

tempCOMVector

javax.vecmath.Vector3d tempCOMVector

tempRVector

javax.vecmath.Vector3d tempRVector

tempRCrossF

javax.vecmath.Vector3d tempRCrossF

tempForce

javax.vecmath.Vector3d tempForce

Class com.yobotics.simulationconstructionset.Simulation extends java.lang.Object implements Serializable

serialVersionUID: 8438645717978048239L

Serialized Fields

myGraphics

Graphics3DAdapter myGraphics

simulationSynchronizer

SimulationSynchronizer simulationSynchronizer

SIMULATION_DT

double SIMULATION_DT

RECORD_FREQ

int RECORD_FREQ

robots

Robot[] robots

mySimulator

Simulator mySimulator

myDataBuffer

DataBuffer myDataBuffer

myCombinedVarList

VarList myCombinedVarList

simulateDoneListeners

java.util.ArrayList<E> simulateDoneListeners

simulateDoneCriterion

SimulationDoneCriterion simulateDoneCriterion

Class com.yobotics.simulationconstructionset.SimulationConstructionSetTest.SimpleRobot extends Robot implements Serializable

serialVersionUID: 43883985473093746L

Class com.yobotics.simulationconstructionset.Simulator extends java.lang.Object implements Serializable

serialVersionUID: -3492879446149849938L

Serialized Fields

simulationSynchronizer

SimulationSynchronizer simulationSynchronizer

robots

Robot[] robots

DT

double DT

scripts

java.util.ArrayList<E> scripts

collisionGroups

java.util.ArrayList<E> collisionGroups

collideablePairs

java.util.ArrayList<E> collideablePairs

Class com.yobotics.simulationconstructionset.SliderJoint extends OneDegreeOfFreedomJoint implements Serializable

serialVersionUID: 1364230363983913667L

Serialized Fields

registry

YoVariableRegistry registry

q

DoubleYoVariable q

qd

DoubleYoVariable qd

qdd

DoubleYoVariable qdd

tau

DoubleYoVariable tau

tau_lim

DoubleYoVariable tau_lim

tau_damp

DoubleYoVariable tau_damp

vTranslate

javax.vecmath.Vector3d vTranslate

hasLimitStops

boolean hasLimitStops

q_min

double q_min

q_max

double q_max

k_limit

double k_limit

b_limit

double b_limit

b_damp

double b_damp

jointVars

VarList jointVars

q_n

double q_n

qd_n

double qd_n

k_qdd

double[] k_qdd

k_qd

double[] k_qd

w_hXr_i

javax.vecmath.Vector3d w_hXr_i

temp1

javax.vecmath.Vector3d temp1

temp2

javax.vecmath.Vector3d temp2

vel_i

javax.vecmath.Vector3d vel_i

Class com.yobotics.simulationconstructionset.SpatialInertiaMatrix extends java.lang.Object implements Serializable

serialVersionUID: 1765931620079414651L

Serialized Fields

A

javax.vecmath.Matrix3d A

B

javax.vecmath.Matrix3d B

C

javax.vecmath.Matrix3d C

D

javax.vecmath.Matrix3d D

IA_s_top

javax.vecmath.Vector3d IA_s_top

IB_s_bottom

javax.vecmath.Vector3d IB_s_bottom

IC_s_top

javax.vecmath.Vector3d IC_s_top

ID_s_bottom

javax.vecmath.Vector3d ID_s_bottom

ONE3d

javax.vecmath.Matrix3d ONE3d

Atop

javax.vecmath.Vector3d Atop

Bbot

javax.vecmath.Vector3d Bbot

Ctop

javax.vecmath.Vector3d Ctop

Dbot

javax.vecmath.Vector3d Dbot

botA

javax.vecmath.Vector3d botA

botB

javax.vecmath.Vector3d botB

topC

javax.vecmath.Vector3d topC

topD

javax.vecmath.Vector3d topD

v1

javax.vecmath.Vector3d v1

v2

javax.vecmath.Vector3d v2

v3

javax.vecmath.Vector3d v3

v4

javax.vecmath.Vector3d v4

A_trans

javax.vecmath.Matrix3d A_trans

B_trans

javax.vecmath.Matrix3d B_trans

C_trans

javax.vecmath.Matrix3d C_trans

D_trans

javax.vecmath.Matrix3d D_trans

Class com.yobotics.simulationconstructionset.SpatialTransformationMatrix extends java.lang.Object implements Serializable

serialVersionUID: -1437839453250728870L

Serialized Fields

R

javax.vecmath.Matrix3d R

r_Twidle

javax.vecmath.Matrix3d r_Twidle

temp1

javax.vecmath.Vector3d temp1

x_Twidle

javax.vecmath.Matrix3d x_Twidle

Rt

javax.vecmath.Matrix3d Rt

R_IA_Rt

javax.vecmath.Matrix3d R_IA_Rt

R_IB_Rt

javax.vecmath.Matrix3d R_IB_Rt

R_IC_Rt

javax.vecmath.Matrix3d R_IC_Rt

R_IB_Rt_r_Twidle

javax.vecmath.Matrix3d R_IB_Rt_r_Twidle

r_Twidle_R_IA_Rt

javax.vecmath.Matrix3d r_Twidle_R_IA_Rt

r_Twidle_R_IB_Rt

javax.vecmath.Matrix3d r_Twidle_R_IB_Rt

r_Twidle_R_IB_Rt_r_Twidle

javax.vecmath.Matrix3d r_Twidle_R_IB_Rt_r_Twidle

Class com.yobotics.simulationconstructionset.SpatialVector extends java.lang.Object implements Serializable

serialVersionUID: 971129051271759424L

Serialized Fields

top

javax.vecmath.Vector3d top

bottom

javax.vecmath.Vector3d bottom

temp1

javax.vecmath.Vector3d temp1

Class com.yobotics.simulationconstructionset.UniversalJoint extends PinJoint implements Serializable

serialVersionUID: 3428274232426974681L

Serialized Fields

joint2

PinJoint joint2

Class com.yobotics.simulationconstructionset.UnreasonableAccelerationException extends java.lang.Throwable implements Serializable

serialVersionUID: 3265459168572596454L

Serialized Fields

unreasonableAccelerationJoints

java.util.ArrayList<E> unreasonableAccelerationJoints

Class com.yobotics.simulationconstructionset.VarList extends java.lang.Object implements Serializable

serialVersionUID: -393664925353518934L

Serialized Fields

listeners

java.util.ArrayList<E> listeners

name

java.lang.String name

variables

java.util.ArrayList<E> variables

Class com.yobotics.simulationconstructionset.YoVariable extends java.lang.Object implements Serializable

serialVersionUID: -4500849226626296884L

Serialized Fields

name

java.lang.String name

registry

YoVariableRegistry registry

shortName

java.lang.String shortName

description

java.lang.String description

variableChangedListeners

java.util.ArrayList<E> variableChangedListeners

manualMinScaling

double manualMinScaling

manualMaxScaling

double manualMaxScaling

Class com.yobotics.simulationconstructionset.YoVariableRegistry extends java.lang.Object implements Serializable

serialVersionUID: -5329859062237747028L

Serialized Fields

controlVars

java.util.ArrayList<E> controlVars

controlVarsHashMap

java.util.LinkedHashMap<K,V> controlVarsHashMap

name

java.lang.String name

nameSpace

NameSpace nameSpace

children

java.util.ArrayList<E> children

parent

YoVariableRegistry parent

simulationRewoundListeners

java.util.ArrayList<E> simulationRewoundListeners

yoVariableRegistryChangedListeners

java.util.ArrayList<E> yoVariableRegistryChangedListeners

disallowSending

boolean disallowSending

isLogged

boolean isLogged

isSent

boolean isSent

Package com.yobotics.simulationconstructionset.gui

Class com.yobotics.simulationconstructionset.gui.BookmarkedVariablesPanel extends VarListVarPanel implements Serializable

serialVersionUID: 1390064658136845739L

Serialized Fields

bookmarkedVariablesHolder

BookmarkedVariablesHolder bookmarkedVariablesHolder

Class com.yobotics.simulationconstructionset.gui.Canvas3DPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -4186691483384418845L

Serialized Fields

view

ViewportAdapterAndCameraControllerHolder view

viewportPanel

ViewportPanel viewportPanel

active

boolean active

border

javax.swing.border.AbstractBorder border

Class com.yobotics.simulationconstructionset.gui.CombinedVarPanel extends javax.swing.JTabbedPane implements Serializable

serialVersionUID: -3403238490036872889L

Serialized Fields

rootRegistry

YoVariableRegistry rootRegistry

tabIndices

java.util.LinkedHashMap<K,V> tabIndices

visibleVarPanel

VarPanel visibleVarPanel

scrollPane

javax.swing.JScrollPane scrollPane

nameSpaceHierarchyTree

NameSpaceHierarchyTree nameSpaceHierarchyTree

splitPane

javax.swing.JSplitPane splitPane

variableDisplayPanel

javax.swing.JPanel variableDisplayPanel

variableSearchPanel

VariableSearchPanel variableSearchPanel

entryBox

YoEntryBox entryBox

alertChangeListenersTimer

java.util.Timer alertChangeListenersTimer

alertChangeListenersTask

java.util.TimerTask alertChangeListenersTask

OBSERVER_NOTIFICATION_PERIOD

long OBSERVER_NOTIFICATION_PERIOD

bookmarkedVariablesScrollPane

javax.swing.JScrollPane bookmarkedVariablesScrollPane

selectedVariableHolder

SelectedVariableHolder selectedVariableHolder

varPanelJPopupMenu

VarPanelJPopupMenu varPanelJPopupMenu

Class com.yobotics.simulationconstructionset.gui.DollyCheckBox extends javax.swing.JCheckBox implements Serializable

serialVersionUID: -6898471398304979545L

Serialized Fields

cameraHolder

ActiveCameraHolder cameraHolder

Class com.yobotics.simulationconstructionset.gui.EntryBoxArrayPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: 269886151605236788L

Serialized Fields

plusButton

javax.swing.JButton plusButton

minusButton

javax.swing.JButton minusButton

entryBoxesOnThisPanel

java.util.ArrayList<E> entryBoxesOnThisPanel

selectedVariableHolder

SelectedVariableHolder selectedVariableHolder

layout

java.awt.FlowLayout layout

alertChangeListenersTimer

java.util.Timer alertChangeListenersTimer

alertChangeListenersTask

java.util.TimerTask alertChangeListenersTask

OBSERVER_NOTIFICATION_PERIOD

long OBSERVER_NOTIFICATION_PERIOD

Class com.yobotics.simulationconstructionset.gui.FFTPlotter extends javax.swing.JFrame implements Serializable

serialVersionUID: 8401116583400863812L

Class com.yobotics.simulationconstructionset.gui.GraphArrayPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -4366771635271760899L

Serialized Fields

graphsOnThisPanel

java.util.ArrayList<E> graphsOnThisPanel

parentFrame

javax.swing.JFrame parentFrame

dataBuffer

DataBuffer dataBuffer

numColumns

int numColumns

MAX_GRAPHS

int MAX_GRAPHS

MAX_COLS

int MAX_COLS

leftPlotIndex

int leftPlotIndex

rightPlotIndex

int rightPlotIndex

selectedVariableHolder

SelectedVariableHolder selectedVariableHolder

oldIndex

int oldIndex

isPainting

boolean isPainting

doTick

int doTick

doIndex

int doIndex

Class com.yobotics.simulationconstructionset.gui.GraphPropertiesPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -8691205074287883807L

Serialized Fields

minTextField

javax.swing.JTextField minTextField

maxTextField

javax.swing.JTextField maxTextField

baseLineTextField

javax.swing.JTextField baseLineTextField

individualButton

javax.swing.JRadioButton individualButton

autoButton

javax.swing.JRadioButton autoButton

manualButton

javax.swing.JRadioButton manualButton

timePlotButton

javax.swing.JRadioButton timePlotButton

phasePlotButton

javax.swing.JRadioButton phasePlotButton

baseLineButton

javax.swing.JRadioButton baseLineButton

createFFTPlotButton

javax.swing.JButton createFFTPlotButton

createBodePlotButton

javax.swing.JButton createBodePlotButton

graph

YoGraph graph

newMinVal

double newMinVal

newMaxVal

double newMaxVal

newBaseVal

double newBaseVal

Class com.yobotics.simulationconstructionset.gui.SplashPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -6476659432543699862L

Serialized Fields

splashImage

java.awt.Image splashImage

splashImageLoaded

boolean splashImageLoaded

Class com.yobotics.simulationconstructionset.gui.TrackCheckBox extends javax.swing.JCheckBox implements Serializable

serialVersionUID: -9012772363648771937L

Serialized Fields

cameraHolder

ActiveCameraHolder cameraHolder

Class com.yobotics.simulationconstructionset.gui.VariableSearchPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -3986327052893068969L

Serialized Fields

dataBuffer

DataBuffer dataBuffer

varPanel

VarListVarPanel varPanel

entryBoxDescriptionArea

javax.swing.JTextArea entryBoxDescriptionArea

entryBox

YoEntryBox entryBox

holder

SelectedVariableHolder holder

label

javax.swing.JLabel label

Class com.yobotics.simulationconstructionset.gui.VariableSearchPanel.VariableSearchField extends javax.swing.JPanel implements Serializable

serialVersionUID: 2584008799193548359L

Serialized Fields

searchTextField

javax.swing.JTextField searchTextField

searchExecutor

java.util.concurrent.Executor searchExecutor

searcher

VariableSearchPanel.VariableSearchField.Searcher searcher

Class com.yobotics.simulationconstructionset.gui.VarListVarPanel extends VarPanel implements Serializable

serialVersionUID: -995471860623897960L

Serialized Fields

varList

VarList varList

Class com.yobotics.simulationconstructionset.gui.VarPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -5860355582880221731L

Serialized Fields

selectedVariableHolder

SelectedVariableHolder selectedVariableHolder

varPanelJPopupMenu

VarPanelJPopupMenu varPanelJPopupMenu

selectedVariableIndex

int selectedVariableIndex

hasFocus

boolean hasFocus

textFields

java.util.ArrayList<E> textFields

numberFormat

java.text.NumberFormat numberFormat

doubleClickListener

DoubleClickListener doubleClickListener

Class com.yobotics.simulationconstructionset.gui.VarPanelJPopupMenu extends javax.swing.JPopupMenu implements Serializable

serialVersionUID: -1080363015468056576L

Serialized Fields

graphArrayPanel

GraphArrayPanel graphArrayPanel

entryBoxArrayPanel

EntryBoxArrayPanel entryBoxArrayPanel

selectedVariableHolder

SelectedVariableHolder selectedVariableHolder

combinedVarPanel

CombinedVarPanel combinedVarPanel

bookmarkedVariablesHolder

BookmarkedVariablesHolder bookmarkedVariablesHolder

bookmarkVariable

javax.swing.JMenuItem bookmarkVariable

Class com.yobotics.simulationconstructionset.gui.VarPanelTransferHandler extends javax.swing.TransferHandler implements Serializable

serialVersionUID: -3557929937089612422L

Class com.yobotics.simulationconstructionset.gui.VarPropertiesPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -1729688086769099783L

Serialized Fields

minTextField

javax.swing.JTextField minTextField

maxTextField

javax.swing.JTextField maxTextField

autoButton

javax.swing.JRadioButton autoButton

manualButton

javax.swing.JRadioButton manualButton

entry

DataEntry entry

newMinVal

double newMinVal

newMaxVal

double newMaxVal

Class com.yobotics.simulationconstructionset.gui.ViewportPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -2903057563160516887L

Serialized Fields

standard3DViews

java.util.ArrayList<E> standard3DViews

canvasPanels

java.util.ArrayList<E> canvasPanels

activeView

ViewportAdapterAndCameraControllerHolder activeView

cameraConfigurationList

CameraConfigurationList cameraConfigurationList

cameraMountList

CameraMountList cameraMountList

yoVariableHolder

YoVariableHolder yoVariableHolder

runCommandsExecutor

RunCommandsExecutor runCommandsExecutor

graphics3DAdapter

Graphics3DAdapter graphics3DAdapter

standardGUIActions

StandardGUIActions standardGUIActions

Class com.yobotics.simulationconstructionset.gui.YoEntryBox extends javax.swing.JPanel implements Serializable

serialVersionUID: -3598041913472018651L

Serialized Fields

USE_NEW_DISPLAY_FOR_ENUMS

boolean USE_NEW_DISPLAY_FOR_ENUMS

activeEntryContainer

YoVariableEntryContainer activeEntryContainer

entryBoxArrayPanel

EntryBoxArrayPanel entryBoxArrayPanel

popupMenu

javax.swing.JPopupMenu popupMenu

selectedVariableHolder

SelectedVariableHolder selectedVariableHolder

Class com.yobotics.simulationconstructionset.gui.YoEntryBoxNew extends javax.swing.JPanel implements Serializable

serialVersionUID: -3598041913472018651L

Serialized Fields

activeEntryContainer

YoEntryBoxNew.YoEntryContainer activeEntryContainer

entryBoxArrayPanel

EntryBoxArrayPanel entryBoxArrayPanel

numFormat

java.text.NumberFormat numFormat

popupMenu

javax.swing.JPopupMenu popupMenu

selectedVariableHolder

SelectedVariableHolder selectedVariableHolder

variableInThisBox

YoVariable variableInThisBox

Class com.yobotics.simulationconstructionset.gui.YoEntryBoxTransferHandler extends javax.swing.TransferHandler implements Serializable

serialVersionUID: 4062923325804002945L

Class com.yobotics.simulationconstructionset.gui.YoGraph extends javax.swing.JPanel implements Serializable

serialVersionUID: -2801526140874071236L

Serialized Fields

graphConfiguration

GraphConfiguration graphConfiguration

parentFrame

javax.swing.JFrame parentFrame

timeDataHolder

TimeDataHolder timeDataHolder

dataEntryHolder

DataEntryHolder dataEntryHolder

graphIndicesHolder

GraphIndicesHolder graphIndicesHolder

yoGraphRemover

YoGraphRemover yoGraphRemover

colors

java.awt.Color[] colors

entriesOnThisGraph

java.util.ArrayList<E> entriesOnThisGraph

selectedVariableHolder

SelectedVariableHolder selectedVariableHolder

min

double min

max

double max

xData

int[] xData

yData

int[] yData

entryNamePaintWidths

java.util.ArrayList<E> entryNamePaintWidths

entryNamePaintRows

java.util.ArrayList<E> entryNamePaintRows

totalEntryNamePaintRows

int totalEntryNamePaintRows

popupMenu

javax.swing.JPopupMenu popupMenu

delete

javax.swing.JMenuItem delete

hadFocus

boolean hadFocus

previousGraphWidth

int previousGraphWidth

stringBuffer

java.lang.StringBuffer stringBuffer

spaceString

java.lang.String spaceString

charArray

char[] charArray

fieldPosition

java.text.FieldPosition fieldPosition

clickedX

int clickedX

clickedY

int clickedY

draggedX

int draggedX

draggedY

int draggedY

clickedIndex

int clickedIndex

clickedLeftIndex

int clickedLeftIndex

clickedRightIndex

int clickedRightIndex

Class com.yobotics.simulationconstructionset.gui.YoGraphTransferHandler extends javax.swing.TransferHandler implements Serializable

serialVersionUID: 6982364243920152679L

Class com.yobotics.simulationconstructionset.gui.YoVariableRegistryVarPanel extends VarPanel implements Serializable

serialVersionUID: -9079475583549031191L

Serialized Fields

registry

YoVariableRegistry registry

Package com.yobotics.simulationconstructionset.gui.actions

Class com.yobotics.simulationconstructionset.gui.actions.AddCameraKeyAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -5162293334622550111L

Serialized Fields

executor

AddCameraKeyCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.AddKeyPointAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -2830335620118067620L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

AddKeyPointCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.CreateNewGraphWindowAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5063019587274426802L

Serialized Fields

executor

CreateNewGraphWindowCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.CreateNewViewportWindowAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 1890952078365483337L

Serialized Fields

executor

CreateNewViewportWindowCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.CropBufferAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5039888169851613916L

Serialized Fields

executor

CropBufferCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.GotoInPointAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -9080927302316708389L

Serialized Fields

iconURL

java.net.URL iconURL

importIcon

javax.swing.ImageIcon importIcon

executor

GotoInPointCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.GotoOutPointAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 4300972053727473361L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

GotoOutPointCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.HideShowViewportAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 1774088226210361744L

Serialized Fields

viewportSelector

ViewportSelectorCommandExecutor viewportSelector

Class com.yobotics.simulationconstructionset.gui.actions.NextCameraKeyAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -5162293334622550111L

Serialized Fields

executor

NextCameraKeyCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.PackBufferAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 3740016405361627977L

Serialized Fields

executor

PackBufferCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.PlayAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -5829585200441213981L

Serialized Fields

iconURL

java.net.URL iconURL

importIcon

javax.swing.ImageIcon importIcon

executor

PlayCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.PreviousCameraKeyAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -5162293334622550111L

Serialized Fields

executor

PreviousCameraKeyCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.RemoveCameraKeyAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -5162293334622550111L

Serialized Fields

executor

RemoveCameraKeyCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.SelectCameraAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -6442315727953394627L

Serialized Fields

name

java.lang.String name

cameraSelector

CameraSelector cameraSelector

Class com.yobotics.simulationconstructionset.gui.actions.SelectGUIConfigFromFileAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -8579530834957317679L

Serialized Fields

fullPath

java.lang.String fullPath

executor

SelectGUIConfigFromFileCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.SetInPointAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 1396893923616884444L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

SetInPointCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.SetOutPointAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 3859062359920445441L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

SetOutPointCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.SimulateAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 2609814986889034283L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

SimulateCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.StepBackwardAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 8975600674258754815L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

StepBackwardCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.StepForwardAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -4007043816767478116L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

StepForwardCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.StopAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 4635663288191284465L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

StopCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.ToggleCameraKeyModeAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -5162293334622550111L

Serialized Fields

executor

ToggleCameraKeyModeCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.ToggleKeyPointModeAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 1500047530568017379L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

ToggleKeyPointModeCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.ZoomInAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -7575893287036365108L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

ZoomGraphCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.ZoomOutAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5487975503056238066L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

executor

ZoomGraphCommandExecutor executor

Package com.yobotics.simulationconstructionset.gui.actions.configActions

Class com.yobotics.simulationconstructionset.gui.actions.configActions.EditVarGroupsAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 2027056071817615114L

Serialized Fields

varGroupList

VarGroupList varGroupList

allVariables

VarList allVariables

frame

javax.swing.JFrame frame

Class com.yobotics.simulationconstructionset.gui.actions.configActions.SelectGraphConfigurationAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -8579530834957317679L

Serialized Fields

name

java.lang.String name

executor

SelectGraphConfigurationCommandExecutor executor

Class com.yobotics.simulationconstructionset.gui.actions.configActions.SelectGraphGroupAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -5534400254284863190L

Serialized Fields

name

java.lang.String name

selector

GraphGroupSelector selector

Class com.yobotics.simulationconstructionset.gui.actions.configActions.SelectVarGroupAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 7027661415555951268L

Serialized Fields

name

java.lang.String name

varGroupSelector

VarGroupSelector varGroupSelector

Class com.yobotics.simulationconstructionset.gui.actions.configActions.SelectViewportAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 6565081288826811421L

Serialized Fields

name

java.lang.String name

selector

ViewportSelectorCommandExecutor selector

Package com.yobotics.simulationconstructionset.gui.actions.dialogActions

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.AboutAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 6795904392077029991L

Serialized Fields

constructor

AboutDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.CameraPropertiesAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 2728147089395054885L

Serialized Fields

constructor

CameraPropertiesDialogConstructor constructor

trackCheckBox

TrackCheckBox trackCheckBox

dollyCheckBox

DollyCheckBox dollyCheckBox

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.DataBufferPropertiesAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -3128885419773084408L

Serialized Fields

constructor

DataBufferPropertiesDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.ExportDataAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -5481556236530603500L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

constructor

ExportDataDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.ExportSimulationTo3DMaxAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 7582935737436636441L

Serialized Fields

constructor

ExportSimulationTo3DMaxDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.ExportSnapshotAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 958525206323850018L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

constructor

ExportSnapshotDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.ImportDataAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 7296204170538611841L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

constructor

ImportDataDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.LoadConfigurationAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5813345490164040993L

Serialized Fields

constructor

LoadConfigurationDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.LoadRobotConfigurationAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5813345490164040993L

Serialized Fields

constructor

LoadRobotConfigurationDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.MediaCaptureAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 1L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

constructor

MediaCaptureDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.PlaybackPropertiesAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 4669984581518228636L

Serialized Fields

constructor

PlaybackPropertiesDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.PrintGraphsAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -4403022630360741566L

Serialized Fields

iconURL

java.net.URL iconURL

icon

javax.swing.ImageIcon icon

constructor

PrintGraphsDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.ResizeViewportAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 8843463124373810864L

Serialized Fields

constructor

ResizeViewportDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.SaveConfigurationAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5813345490164040993L

Serialized Fields

constructor

SaveConfigurationDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.SaveGraphConfigurationAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5813345490164040993L

Serialized Fields

constructor

SaveGraphConfigurationDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.SaveRobotConfigurationAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5813345490164040993L

Serialized Fields

constructor

SaveRobotConfigurationDialogConstructor constructor

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.SelectEntryBoxGroupAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 2957716760331114426L

Serialized Fields

name

java.lang.String name

selector

EntryBoxGroupSelector selector

Class com.yobotics.simulationconstructionset.gui.actions.dialogActions.SelectExtraPanelAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: -6442315727953394627L

Serialized Fields

name

java.lang.String name

selectExtraPanelAction

ExtraPanelSelector selectExtraPanelAction

Package com.yobotics.simulationconstructionset.gui.dialogs

Class com.yobotics.simulationconstructionset.gui.dialogs.CameraPropertiesDialog extends javax.swing.JDialog implements Serializable

serialVersionUID: 859815534934501986L

Serialized Fields

numFormat

java.text.NumberFormat numFormat

trackCheckBox

javax.swing.JCheckBox trackCheckBox

trackXCheckBox

javax.swing.JCheckBox trackXCheckBox

trackYCheckBox

javax.swing.JCheckBox trackYCheckBox

trackZCheckBox

javax.swing.JCheckBox trackZCheckBox

dollyCheckBox

javax.swing.JCheckBox dollyCheckBox

dollyXCheckBox

javax.swing.JCheckBox dollyXCheckBox

dollyYCheckBox

javax.swing.JCheckBox dollyYCheckBox

dollyZCheckBox

javax.swing.JCheckBox dollyZCheckBox

trackXTextField

javax.swing.JTextField trackXTextField

trackYTextField

javax.swing.JTextField trackYTextField

trackZTextField

javax.swing.JTextField trackZTextField

dollyXTextField

javax.swing.JTextField dollyXTextField

dollyYTextField

javax.swing.JTextField dollyYTextField

dollyZTextField

javax.swing.JTextField dollyZTextField

fixXTextField

javax.swing.JTextField fixXTextField

fixYTextField

javax.swing.JTextField fixYTextField

fixZTextField

javax.swing.JTextField fixZTextField

camXTextField

javax.swing.JTextField camXTextField

camYTextField

javax.swing.JTextField camYTextField

camZTextField

javax.swing.JTextField camZTextField

newTrackDx

double newTrackDx

newTrackDy

double newTrackDy

newTrackDz

double newTrackDz

newDollyDx

double newDollyDx

newDollyDy

double newDollyDy

newDollyDz

double newDollyDz

newFixX

double newFixX

newFixY

double newFixY

newFixZ

double newFixZ

newCamX

double newCamX

newCamY

double newCamY

newCamZ

double newCamZ

trackCurrentButton

javax.swing.JButton trackCurrentButton

dollyCurrentButton

javax.swing.JButton dollyCurrentButton

okButton

javax.swing.JButton okButton

applyButton

javax.swing.JButton applyButton

cancelButton

javax.swing.JButton cancelButton

cameraPropertiesPanel

CameraPropertiesDialog.CameraPropertiesPanel cameraPropertiesPanel

parentContainer

java.awt.Container parentContainer

parentFrame

javax.swing.JFrame parentFrame

cameraHolder

ActiveCameraHolder cameraHolder

GUITrackCheckBox

javax.swing.JCheckBox GUITrackCheckBox

GUIDollyCheckBox

javax.swing.JCheckBox GUIDollyCheckBox

Class com.yobotics.simulationconstructionset.gui.dialogs.CameraPropertiesDialog.CameraPropertiesPanel extends javax.swing.JPanel implements Serializable

Class com.yobotics.simulationconstructionset.gui.dialogs.CameraPropertiesDialog.DollyCurrentButton extends javax.swing.JButton implements Serializable

serialVersionUID: 6700937880902001238L

Class com.yobotics.simulationconstructionset.gui.dialogs.CameraPropertiesDialog.TrackCurrentButton extends javax.swing.JButton implements Serializable

serialVersionUID: -4680530982540091563L

Class com.yobotics.simulationconstructionset.gui.dialogs.DataBufferPropertiesDialog extends javax.swing.JDialog implements Serializable

serialVersionUID: 3689240296926827447L

Serialized Fields

maxTextField

javax.swing.JTextField maxTextField

currentTextField

javax.swing.JTextField currentTextField

wrapButton

javax.swing.JRadioButton wrapButton

enlargeButton

javax.swing.JRadioButton enlargeButton

newMaxVal

int newMaxVal

newCurrentVal

int newCurrentVal

okButton

javax.swing.JButton okButton

applyButton

javax.swing.JButton applyButton

cancelButton

javax.swing.JButton cancelButton

bufferPropertiesPanel

DataBufferPropertiesDialog.BufferPropertiesPanel bufferPropertiesPanel

listener

DataBufferChangeListener listener

dataBuffer

DataBuffer dataBuffer

Class com.yobotics.simulationconstructionset.gui.dialogs.DataBufferPropertiesDialog.BufferPropertiesPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -3906496391997459515L

Class com.yobotics.simulationconstructionset.gui.dialogs.ExportDataDialog extends javax.swing.JDialog implements Serializable

serialVersionUID: 8567689788428234128L

Serialized Fields

exportButton

javax.swing.JButton exportButton

cancelButton

javax.swing.JButton cancelButton

exportPanel

com.yobotics.simulationconstructionset.gui.dialogs.ExportDataDialog.ExportDataPanel exportPanel

parentFrame

javax.swing.JFrame parentFrame

listener

ExportDataDialogListener listener

varGroupList

VarGroupList varGroupList

Class com.yobotics.simulationconstructionset.gui.dialogs.GraphPropertiesDialog extends javax.swing.JDialog implements Serializable

serialVersionUID: 723781387756094595L

Serialized Fields

okButton

javax.swing.JButton okButton

applyButton

javax.swing.JButton applyButton

cancelButton

javax.swing.JButton cancelButton

graphPropertiesPanel

GraphPropertiesPanel graphPropertiesPanel

varPropertiesPanels

VarPropertiesPanel[] varPropertiesPanels

parentFrame

javax.swing.JFrame parentFrame

Class com.yobotics.simulationconstructionset.gui.dialogs.PlaybackPropertiesDialog extends javax.swing.JDialog implements Serializable

serialVersionUID: -8226475433536336684L

Serialized Fields

okButton

javax.swing.JButton okButton

applyButton

javax.swing.JButton applyButton

cancelButton

javax.swing.JButton cancelButton

playbackPropertiesPanel

PlaybackPropertiesDialog.PlaybackPropertiesPanel playbackPropertiesPanel

ownerFrame

javax.swing.JFrame ownerFrame

parentContainer

java.awt.Container parentContainer

sim

SimulationConstructionSet sim

Class com.yobotics.simulationconstructionset.gui.dialogs.PlaybackPropertiesDialog.PlaybackPropertiesPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -6809250560000939671L

Serialized Fields

newRealTimeVal

double newRealTimeVal

newFrameRateVal

double newFrameRateVal

newSimulateDurationVal

double newSimulateDurationVal

gridBagLayout1

java.awt.GridBagLayout gridBagLayout1

updateGraphsCheckbox

javax.swing.JCheckBox updateGraphsCheckbox

realTimeRateLabel

javax.swing.JLabel realTimeRateLabel

desiredFrameRateLabel

javax.swing.JLabel desiredFrameRateLabel

simulateDurationLabel

javax.swing.JLabel simulateDurationLabel

realTimeTextField

javax.swing.JTextField realTimeTextField

frameRateTextField

javax.swing.JTextField frameRateTextField

simulateDurationTextField

javax.swing.JTextField simulateDurationTextField

Class com.yobotics.simulationconstructionset.gui.dialogs.VarPropertiesDialog extends javax.swing.JDialog implements Serializable

serialVersionUID: 5673404867619146740L

Serialized Fields

okButton

javax.swing.JButton okButton

applyButton

javax.swing.JButton applyButton

cancelButton

javax.swing.JButton cancelButton

varPropertiesPanels

VarPropertiesPanel[] varPropertiesPanels

parentFrame

javax.swing.JFrame parentFrame

Package com.yobotics.simulationconstructionset.gui.hierarchyTree

Class com.yobotics.simulationconstructionset.gui.hierarchyTree.NameSpaceHierarchyNodeRenderer extends javax.swing.JPanel implements Serializable

serialVersionUID: -6793795042915360102L

Serialized Fields

sendCheck

javax.swing.JCheckBox sendCheck

logCheck

javax.swing.JCheckBox logCheck

label

com.yobotics.simulationconstructionset.gui.hierarchyTree.NameSpaceHierarchyNodeRenderer.TreeLabel label

treeNodeRegistryMap

java.util.HashMap<K,V> treeNodeRegistryMap

Class com.yobotics.simulationconstructionset.gui.hierarchyTree.NameSpaceHierarchyTree extends javax.swing.JScrollPane implements Serializable

serialVersionUID: -8489413083414697473L

Serialized Fields

tree

javax.swing.JTree tree

fileChooser

javax.swing.JFileChooser fileChooser

model

javax.swing.tree.DefaultTreeModel model

top

javax.swing.tree.DefaultMutableTreeNode top

registryTreeNodeMap

java.util.LinkedHashMap<K,V> registryTreeNodeMap

treeNodeRegistryMap

java.util.LinkedHashMap<K,V> treeNodeRegistryMap

frame

javax.swing.JFrame frame

writeDataCommandExecutor

WriteDataCommandExecutor writeDataCommandExecutor

registrySelectedListener

RegistrySelectedListener registrySelectedListener

popupMenu

javax.swing.JPopupMenu popupMenu

root

YoVariableRegistry root

registrySettingsChangedListeners

java.util.ArrayList<E> registrySettingsChangedListeners

Package com.yobotics.simulationconstructionset.mathfunctions

Class com.yobotics.simulationconstructionset.mathfunctions.QuarticEquationSolver extends java.lang.Object implements Serializable

serialVersionUID: -256535947296433934L

Serialized Fields

cube_root_t_real

double[] cube_root_t_real

cube_root_u_real

double[] cube_root_u_real

cube_root_t_imag

double[] cube_root_t_imag

cube_root_u_imag

double[] cube_root_u_imag

temp_real

double[] temp_real

temp_imag

double[] temp_imag

temp2_real

double[] temp2_real

temp2_imag

double[] temp2_imag

Class com.yobotics.simulationconstructionset.mathfunctions.QuarticRootFinder extends java.lang.Object implements Serializable

serialVersionUID: 1492976164809974715L

Serialized Fields

cubic_overflow_coeffs

double[] cubic_overflow_coeffs

coeffs

double[] coeffs

s_temp

double[] s_temp

quartic_overflow_coeffs

double[] quartic_overflow_coeffs

Package com.yobotics.simulationconstructionset.plotting

Class com.yobotics.simulationconstructionset.plotting.DynamicGraphicPolygonArtifact extends Artifact implements Serializable

serialVersionUID: -1497178395194861659L

Serialized Fields

dynamicGraphicPolygon

DynamicGraphicPolygon dynamicGraphicPolygon

plotterGraphics

PlotterGraphics plotterGraphics

color

java.awt.Color color

Class com.yobotics.simulationconstructionset.plotting.DynamicGraphicPositionArtifact extends Artifact implements Serializable

serialVersionUID: -1824071784539220859L

Serialized Fields

dynamicGraphicPosition

DynamicGraphicPosition dynamicGraphicPosition

historicalPositions

java.util.ArrayList<E> historicalPositions

position

javax.vecmath.Point3d position

Class com.yobotics.simulationconstructionset.plotting.DynamicGraphicVectorArtifact extends Artifact implements Serializable

serialVersionUID: 2379549723591744368L

Serialized Fields

dynamicGraphicVector

DynamicGraphicVector dynamicGraphicVector

plotterGraphics

PlotterGraphics plotterGraphics

color

javax.vecmath.Color3f color

basePoint3d

javax.vecmath.Point3d basePoint3d

vector3d

javax.vecmath.Vector3d vector3d

basePoint

javax.vecmath.Point2d basePoint

vector

javax.vecmath.Vector2d vector

endPoint

javax.vecmath.Point2d endPoint

arrowHeadPoints

java.util.ArrayList<E> arrowHeadPoints

Class com.yobotics.simulationconstructionset.plotting.DynamicGraphicYoCircleArtifact extends Artifact implements Serializable

serialVersionUID: -2167502158140538192L

Serialized Fields

center

YoFramePoint2d center

radius

DoubleYoVariable radius

isFilledCircle

java.lang.Boolean isFilledCircle

Class com.yobotics.simulationconstructionset.plotting.DynamicGraphicYoPolygonArtifact extends Artifact implements Serializable

serialVersionUID: 1595929952165656135L

Serialized Fields

yoConvexPolygon2d

YoFrameConvexPolygon2d yoConvexPolygon2d

polygonPoints

double[][] polygonPoints

plotterGraphics

PlotterGraphics plotterGraphics

fill

boolean fill

Class com.yobotics.simulationconstructionset.plotting.DynamicGraphicYoVectorArtifact extends Artifact implements Serializable

serialVersionUID: 374256294846738354L

Serialized Fields

plotterGraphics

PlotterGraphics plotterGraphics

color

javax.vecmath.Color3f color

basePoint

YoFramePoint2d basePoint

vector

YoFrameVector2d vector

endPoint

javax.vecmath.Point2d endPoint

arrowHeadPoints

java.util.ArrayList<E> arrowHeadPoints

Class com.yobotics.simulationconstructionset.plotting.YoFrameLine2dArtifact extends Artifact implements Serializable

serialVersionUID: 5741633846461834438L

Serialized Fields

yoFrameLine2d

YoFrameLine2d yoFrameLine2d

plotterGraphics

PlotterGraphics plotterGraphics

color

java.awt.Color color

Class com.yobotics.simulationconstructionset.plotting.YoFrameLineSegment2dArtifact extends Artifact implements Serializable

serialVersionUID: -2067732984899803547L

Serialized Fields

yoFrameLineSegment2d

YoFrameLineSegment2d yoFrameLineSegment2d

plotterGraphics

PlotterGraphics plotterGraphics

color

java.awt.Color color

Package com.yobotics.simulationconstructionset.robotcommprotocol

Class com.yobotics.simulationconstructionset.robotcommprotocol.SCSRobotGUICommunicatorComponents.ConnectButton extends javax.swing.JButton implements Serializable

serialVersionUID: -2191752688240579800L

Class com.yobotics.simulationconstructionset.robotcommprotocol.SCSRobotGUICommunicatorComponents.PauseButton extends javax.swing.JButton implements Serializable

serialVersionUID: 3465225805490022043L

Class com.yobotics.simulationconstructionset.robotcommprotocol.SCSRobotGUICommunicatorComponents.RecordCheckBox extends javax.swing.JCheckBox implements Serializable

serialVersionUID: 3858416227113728288L


Package com.yobotics.simulationconstructionset.simulatedSensors

Class com.yobotics.simulationconstructionset.simulatedSensors.LidarDataPacket extends java.util.ArrayList<javax.vecmath.Point3d> implements Serializable

serialVersionUID: 3102705118506458615L

Class com.yobotics.simulationconstructionset.simulatedSensors.NotReadyException extends java.lang.Exception implements Serializable

serialVersionUID: 8684291629565409542L

Class com.yobotics.simulationconstructionset.simulatedSensors.SingleRigidBodyRobot extends Robot implements Serializable

serialVersionUID: -7671864179791904256L

Serialized Fields

bodyJoint

FloatingJoint bodyJoint

forcePoint

ExternalForcePoint forcePoint

Class com.yobotics.simulationconstructionset.simulatedSensors.SpoofNetoworkSimulatedLidar.LIDARScan extends java.lang.Object implements Serializable

serialVersionUID: 6533143962275276098L

Serialized Fields

points

java.util.ArrayList<E> points

initialTime

long initialTime

Class com.yobotics.simulationconstructionset.simulatedSensors.UnexpectedConcurrancyException extends java.lang.Exception implements Serializable

serialVersionUID: -2399934723168629373L


Package com.yobotics.simulationconstructionset.util

Class com.yobotics.simulationconstructionset.util.CollisionGroundContactModel extends java.lang.Object implements Serializable

serialVersionUID: -1038863972028441303L

Serialized Fields

registry

YoVariableRegistry registry

groundRestitution

DoubleYoVariable groundRestitution

groundFriction

DoubleYoVariable groundFriction

gcPoints

java.util.ArrayList<E> gcPoints

profile

GroundProfile profile

movingProfile

MovingGroundProfile movingProfile

microCollision

boolean microCollision

normalVector

javax.vecmath.Vector3d normalVector

velocityVector

javax.vecmath.Vector3d velocityVector

p_world

javax.vecmath.Vector3d p_world

iterateForward

boolean iterateForward

jj

int jj

closestIntersection

javax.vecmath.Point3d closestIntersection

Class com.yobotics.simulationconstructionset.util.ExperimentalLinearStickSlipGroundContactModel extends java.lang.Object implements Serializable

serialVersionUID: -2481515446904072547L

Serialized Fields

registry

YoVariableRegistry registry

K_XY

DoubleYoVariable K_XY

B_XY

DoubleYoVariable B_XY

K_Z

DoubleYoVariable K_Z

B_Z

DoubleYoVariable B_Z

NOMLEN

DoubleYoVariable NOMLEN

ALPHA_SLIP

DoubleYoVariable ALPHA_SLIP

ALPHA_STICK

DoubleYoVariable ALPHA_STICK

gcPoints

java.util.ArrayList<E> gcPoints

profile

GroundProfile profile

normalWorld

javax.vecmath.Vector3d normalWorld

forceWorld

javax.vecmath.Vector3d forceWorld

forceNormal

javax.vecmath.Vector3d forceNormal

forceParallel

javax.vecmath.Vector3d forceParallel

inPlaneVector1

javax.vecmath.Vector3d inPlaneVector1

inPlaneVector2

javax.vecmath.Vector3d inPlaneVector2

tempVector

javax.vecmath.Vector3d tempVector

touchDownPoint

javax.vecmath.Point3d touchDownPoint

contactPoint

javax.vecmath.Point3d contactPoint

Class com.yobotics.simulationconstructionset.util.LinearGroundContactModel extends java.lang.Object implements Serializable

serialVersionUID: 2992692652883785621L

Serialized Fields

registry

YoVariableRegistry registry

K_XY

DoubleYoVariable K_XY

B_XY

DoubleYoVariable B_XY

K_Z

DoubleYoVariable K_Z

B_Z

DoubleYoVariable B_Z

NOMLEN

DoubleYoVariable NOMLEN

gcPoints

java.util.ArrayList<E> gcPoints

profile

GroundProfile profile

Class com.yobotics.simulationconstructionset.util.LinearStickSlipGroundContactModel extends java.lang.Object implements Serializable

serialVersionUID: -2481515446904072547L

Serialized Fields

registry

YoVariableRegistry registry

groundKxy

DoubleYoVariable groundKxy

groundBxy

DoubleYoVariable groundBxy

groundKz

DoubleYoVariable groundKz

groundBz

DoubleYoVariable groundBz

groundStiffeningLength

DoubleYoVariable groundStiffeningLength

groundAlphaSlip

DoubleYoVariable groundAlphaSlip

groundAlphaStick

DoubleYoVariable groundAlphaStick

gcPoints

java.util.ArrayList<E> gcPoints

profile

GroundProfile profile

normalWorld

javax.vecmath.Vector3d normalWorld

forceWorld

javax.vecmath.Vector3d forceWorld

forceNormal

javax.vecmath.Vector3d forceNormal

forceParallel

javax.vecmath.Vector3d forceParallel

Package com.yobotics.simulationconstructionset.util.environments

Class com.yobotics.simulationconstructionset.util.environments.ContactablePinJointRobot extends Robot implements Serializable

serialVersionUID: -3371489685439165270L

Serialized Fields

articulatedContactable

com.yobotics.simulationconstructionset.util.environments.ContactablePinJointRobot.InternalArticulatedContactable articulatedContactable

Class com.yobotics.simulationconstructionset.util.environments.ContactableRobot extends Robot implements Serializable

serialVersionUID: -3371489685439165270L

Serialized Fields

articulatedContactable

com.yobotics.simulationconstructionset.util.environments.ContactableRobot.InternalArticulatedContactable articulatedContactable

Class com.yobotics.simulationconstructionset.util.environments.ContactableSelectableBoxRobot extends ContactableRobot implements Serializable

serialVersionUID: 5151131578635917171L

Serialized Fields

frameBox

FrameBox3d frameBox

floatingJoint

FloatingJoint floatingJoint

boxLink

Link boxLink

linkGraphics

Graphics3DObject linkGraphics

faceGraphics

java.util.EnumMap<K extends java.lang.Enum<K>,V> faceGraphics

selectedDirection

EnumYoVariable<T extends java.lang.Enum<T>> selectedDirection

selectTransparency

double selectTransparency

unselectTransparency

double unselectTransparency

selectedListeners

java.util.ArrayList<E> selectedListeners

temporaryTransform3D

javax.media.j3d.Transform3D temporaryTransform3D

Class com.yobotics.simulationconstructionset.util.environments.ContactableSphereRobot extends ContactableRobot implements Serializable

serialVersionUID: -542892147867471151L

Serialized Fields

floatingJoint

FloatingJoint floatingJoint

originalSphere3d

Sphere3d originalSphere3d

currentSphere3d

Sphere3d currentSphere3d

sphereLink

Link sphereLink

temporaryTransform3D

javax.media.j3d.Transform3D temporaryTransform3D

Class com.yobotics.simulationconstructionset.util.environments.ContactableStaticCylinderRobot extends ContactableStaticRobot implements Serializable

serialVersionUID: -9222718517284272299L

Serialized Fields

cylinder

FrameCylinder3d cylinder

nullJoint

NullJoint nullJoint

cylinderLink

Link cylinderLink

linkGraphics

Graphics3DObject linkGraphics

selectTransparency

double selectTransparency

unselectTransparency

double unselectTransparency

cylinderGraphic

Graphics3DAddMeshDataInstruction cylinderGraphic

selectedListeners

java.util.ArrayList<E> selectedListeners

Class com.yobotics.simulationconstructionset.util.environments.ContactableStaticRobot extends Robot implements Serializable

serialVersionUID: -3371489685439165270L

Serialized Fields

articulatedContactable

com.yobotics.simulationconstructionset.util.environments.ContactableStaticRobot.InternalArticulatedContactable articulatedContactable

Class com.yobotics.simulationconstructionset.util.environments.ContactableToroidRobot extends ContactablePinJointRobot implements Serializable

serialVersionUID: -9222717517284272299L

Serialized Fields

wheelTorus

FrameTorus3d wheelTorus

pinJoint

PinJoint pinJoint

wheelLink

Link wheelLink

linkGraphics

Graphics3DObject linkGraphics

selectTransparency

double selectTransparency

unselectTransparency

double unselectTransparency

wheelGraphic

Graphics3DAddMeshDataInstruction wheelGraphic

selectedListeners

java.util.ArrayList<E> selectedListeners

Class com.yobotics.simulationconstructionset.util.environments.PointMassRobot extends Robot implements Serializable

serialVersionUID: 471055183219410116L

Serialized Fields

xJoint

SliderJoint xJoint

yJoint

SliderJoint yJoint

zJoint

SliderJoint zJoint

externalForcePoint

ExternalForcePoint externalForcePoint

zLink

Link zLink

Package com.yobotics.simulationconstructionset.util.graphics

Class com.yobotics.simulationconstructionset.util.graphics.DynamicGraphicCheckBoxMenuItem extends javax.swing.JCheckBoxMenuItem implements Serializable

serialVersionUID: -1641762511153430886L

Serialized Fields

dynamicGraphicObjects

java.util.ArrayList<E> dynamicGraphicObjects

Package com.yobotics.simulationconstructionset.util.graphs

Class com.yobotics.simulationconstructionset.util.graphs.FrequencyPlot extends JFreePlot implements Serializable

serialVersionUID: 256604511093215927L

Class com.yobotics.simulationconstructionset.util.graphs.JFreeGraph extends javax.swing.JPanel implements Serializable

serialVersionUID: -2146727132718915859L

Serialized Fields

graph

org.jfree.chart.JFreeChart graph

xySeriesCollection

org.jfree.data.xy.XYSeriesCollection xySeriesCollection

xLabel

java.lang.String xLabel

yLabel

java.lang.String yLabel

plots

java.util.ArrayList<E> plots

title

java.lang.String title

image

java.awt.image.BufferedImage image

xAxisScaling

JFreeGraph.AxisScaling xAxisScaling

yAxisScaling

JFreeGraph.AxisScaling yAxisScaling

Class com.yobotics.simulationconstructionset.util.graphs.JFreeGraphGroup extends javax.swing.JPanel implements Serializable

Serialized Fields

graphs

java.util.ArrayList<E> graphs

graphsPerRow

int graphsPerRow

Class com.yobotics.simulationconstructionset.util.graphs.JFreePlot extends org.jfree.data.xy.XYSeries implements Serializable

serialVersionUID: -5258162352646570327L

Serialized Fields

type

JFreePlot.PlotTypes type

color

java.awt.Color color

name

java.lang.String name

xPlot

double[] xPlot

yPlot

double[] yPlot

solid

java.awt.BasicStroke solid

doted

java.awt.BasicStroke doted

dashed

java.awt.BasicStroke dashed

Package com.yobotics.simulationconstructionset.util.gui

Class com.yobotics.simulationconstructionset.util.gui.YoGUIMessagePanel extends javax.swing.JPanel implements Serializable

serialVersionUID: 1715136701882332438L

Serialized Fields

name

java.lang.String name

textArea

javax.swing.JTextArea textArea

jScrollPane

javax.swing.JScrollPane jScrollPane

QUIET

boolean QUIET

Class com.yobotics.simulationconstructionset.util.gui.YoVariableSimpleStatusDisplay extends javax.swing.JLabel implements Serializable

Serialized Fields

trueString

java.lang.String trueString

falseString

java.lang.String falseString

trueColor

java.awt.Color trueColor

falseColor

java.awt.Color falseColor

currentStateVariable

BooleanYoVariable currentStateVariable

Class com.yobotics.simulationconstructionset.util.gui.YoVariableStatusDisplay extends javax.swing.JLabel implements Serializable

Serialized Fields

buttonToggleState

YoVariableToggler buttonToggleState

useImageTrue

boolean useImageTrue

useImageFalse

boolean useImageFalse

trueColor

java.awt.Color trueColor

falseColor

java.awt.Color falseColor

trueIcon

javax.swing.ImageIcon trueIcon

falseIcon

javax.swing.ImageIcon falseIcon

Class com.yobotics.simulationconstructionset.util.gui.YoVariableToggleButton extends javax.swing.JButton implements Serializable

Serialized Fields

MILLIS_TO_WAIT_FOR_RESPONSE

int MILLIS_TO_WAIT_FOR_RESPONSE

buttonToggleState

YoVariableToggler buttonToggleState

stateChanged

boolean stateChanged

Package com.yobotics.simulationconstructionset.util.math

Class com.yobotics.simulationconstructionset.util.math.TimestampedVelocityYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -781148324206085726L

Serialized Fields

position

DoubleYoVariable position

previousPosition

DoubleYoVariable previousPosition

timestamp

DoubleYoVariable timestamp

previousTimestamp

DoubleYoVariable previousTimestamp

hasBeenUpdated

BooleanYoVariable hasBeenUpdated

epsilonChange

double epsilonChange

Package com.yobotics.simulationconstructionset.util.math.filter

Class com.yobotics.simulationconstructionset.util.math.filter.AlphaBetaFilteredYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -4181586856303408596L

Serialized Fields

alpha

double alpha

beta

double beta

DT

double DT

alphaVariable

DoubleYoVariable alphaVariable

betaVariable

DoubleYoVariable betaVariable

positionState

DoubleYoVariable positionState

xMeasuredVariable

DoubleYoVariable xMeasuredVariable

Class com.yobotics.simulationconstructionset.util.math.filter.AlphaFilteredYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: 8354935442849297950L

Serialized Fields

alpha

double alpha

alphaVariable

DoubleYoVariable alphaVariable

position

DoubleYoVariable position

hasBeenCalled

BooleanYoVariable hasBeenCalled

Class com.yobotics.simulationconstructionset.util.math.filter.AlphaFusedYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -6043187045769612413L

Serialized Fields

alpha

double alpha

alphaVariable

DoubleYoVariable alphaVariable

slowSignal

DoubleYoVariable slowSignal

fastSignal

DoubleYoVariable fastSignal

steadyStateOffset

DoubleYoVariable steadyStateOffset

hasBeenCalled

BooleanYoVariable hasBeenCalled

Class com.yobotics.simulationconstructionset.util.math.filter.BetaFilteredYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -310825747905352639L

Serialized Fields

beta

int beta

index

int index

betaVariable

DoubleYoVariable betaVariable

position

DoubleYoVariable position

hasBeenCalled

BooleanYoVariable hasBeenCalled

Class com.yobotics.simulationconstructionset.util.math.filter.ButterworthFilteredYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -3919931979157660138L

Serialized Fields

alpha

double alpha

alphaVariable

DoubleYoVariable alphaVariable

position

DoubleYoVariable position

previousInput

DoubleYoVariable previousInput

hasBeenCalled

BooleanYoVariable hasBeenCalled

butterworthFilterType

ButterworthFilteredYoVariable.ButterworthFilterType butterworthFilterType

Class com.yobotics.simulationconstructionset.util.math.filter.ButterworthFusedYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -1583548692210980044L

Serialized Fields

lowPassFilteredSlowVariable

ButterworthFilteredYoVariable lowPassFilteredSlowVariable

highPassFilteredFastVariable

ButterworthFilteredYoVariable highPassFilteredFastVariable

Class com.yobotics.simulationconstructionset.util.math.filter.DelayedBooleanYoVariable extends BooleanYoVariable implements Serializable

serialVersionUID: -7292827989667274262L

Serialized Fields

variableToDelay

BooleanYoVariable variableToDelay

previousYoVariables

BooleanYoVariable[] previousYoVariables

Class com.yobotics.simulationconstructionset.util.math.filter.DelayedDoubleYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -7292827989667274262L

Serialized Fields

variableToDelay

DoubleYoVariable variableToDelay

previousYoVariables

DoubleYoVariable[] previousYoVariables

Class com.yobotics.simulationconstructionset.util.math.filter.FilteredDiscreteVelocityYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -1706307241664937480L

Serialized Fields

alpha

double alpha

time

DoubleYoVariable time

alphaVariable

DoubleYoVariable alphaVariable

position

DoubleYoVariable position

lastUpdateTime

DoubleYoVariable lastUpdateTime

lastUpdateDirection

EnumYoVariable<T extends java.lang.Enum<T>> lastUpdateDirection

unfilteredVelocity

DoubleYoVariable unfilteredVelocity

lastPosition

DoubleYoVariable lastPosition

hasBeenCalled

boolean hasBeenCalled

Class com.yobotics.simulationconstructionset.util.math.filter.FilteredVelocityYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -8817565690674286003L

Serialized Fields

alphaDouble

double alphaDouble

dt

double dt

alphaVariable

DoubleYoVariable alphaVariable

position

DoubleYoVariable position

lastPosition

DoubleYoVariable lastPosition

hasBeenCalled

BooleanYoVariable hasBeenCalled

Class com.yobotics.simulationconstructionset.util.math.filter.GlitchFilteredBooleanYoVariable extends BooleanYoVariable implements Serializable

serialVersionUID: -5787036162782799032L

Serialized Fields

variableToFilter

BooleanYoVariable variableToFilter

windowSize

IntegerYoVariable windowSize

previousValue

BooleanYoVariable previousValue

counter

IntegerYoVariable counter

Class com.yobotics.simulationconstructionset.util.math.filter.HysteresisFilteredYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -6576385981232462215L

Serialized Fields

hysteresisAmount

DoubleYoVariable hysteresisAmount

previousUnfilteredValue

double previousUnfilteredValue

upperLimit

double upperLimit

lowerLimit

double lowerLimit

initialized

boolean initialized

Class com.yobotics.simulationconstructionset.util.math.filter.InfiniteImpulseResponseFilteredYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -2471942137275331516L

Serialized Fields

DEBUG

boolean DEBUG

numPoles

int numPoles

numZeros

int numZeros

denominatorCoefficients

double[] denominatorCoefficients

numeratorCoefficients

double[] numeratorCoefficients

previousX

double[] previousX

previousY

double[] previousY

Class com.yobotics.simulationconstructionset.util.math.filter.RampedAlphaFilteredYoVariable extends AlphaFilteredYoVariable implements Serializable

serialVersionUID: 1092968368090018263L

Serialized Fields

time

DoubleYoVariable time

startTime

DoubleYoVariable startTime

startAlpha

DoubleYoVariable startAlpha

endAlpha

DoubleYoVariable endAlpha

rampTime

DoubleYoVariable rampTime

Class com.yobotics.simulationconstructionset.util.math.filter.RateLimitedYoVariable extends DoubleYoVariable implements Serializable

serialVersionUID: -7275713897896161277L

Serialized Fields

maxRate

double maxRate

maxRateVariable

DoubleYoVariable maxRateVariable

position

DoubleYoVariable position

dt

double dt

hasBeenCalled

BooleanYoVariable hasBeenCalled

Class com.yobotics.simulationconstructionset.util.math.filter.SimpleMovingAverageFilteredYoVariable extends DoubleYoVariable implements Serializable

Serialized Fields

windowSize

int windowSize

yoVariableToFilter

DoubleYoVariable yoVariableToFilter

previousUpdateValues

java.lang.Double[] previousUpdateValues

bufferPosition

int bufferPosition

Class com.yobotics.simulationconstructionset.util.math.filter.TwoVariableTransitionFilter extends DoubleYoVariable implements Serializable

serialVersionUID: 5863096313837532306L

Serialized Fields

transitionStartTime

DoubleYoVariable transitionStartTime

time

DoubleYoVariable time

lengthOfTransitionTime

double lengthOfTransitionTime

Package com.yobotics.simulationconstructionset.util.perturbance

Class com.yobotics.simulationconstructionset.util.perturbance.LaunchedBall extends FloatingJoint implements Serializable

serialVersionUID: -1070304629726153858L

Serialized Fields

launched

boolean launched

finalPosition

javax.vecmath.Point3d finalPosition

currentPosition

javax.vecmath.Point3d currentPosition

directionVector

javax.vecmath.Vector3d directionVector

velocityVector

javax.vecmath.Vector3d velocityVector

collisionDistance

double collisionDistance

density

double density

linkGraphicsScale

Graphics3DScaleInstruction linkGraphicsScale

Package com.yobotics.simulationconstructionset.util.simulationRunner

Class com.yobotics.simulationconstructionset.util.simulationRunner.BlockingSimulationRunner.SimulationExceededMaximumTimeException extends java.lang.Exception implements Serializable

serialVersionUID: 9041559998947724357L


Package com.yobotics.simulationconstructionset.util.statemachines

Class com.yobotics.simulationconstructionset.util.statemachines.StateMachinesJPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: 2453853798153829891L

Serialized Fields

stateMachine

StateMachine<E extends java.lang.Enum<E>> stateMachine

oldStateDiagram

boolean oldStateDiagram

stateCells

org.jgraph.graph.DefaultGraphCell[] stateCells

graph

org.jgraph.JGraph graph

numberOfStates

int numberOfStates

currentState

java.lang.Enum<E extends java.lang.Enum<E>> currentState

sourceArrows

int[] sourceArrows

targetArrows

int[] targetArrows

sourceArrowIndex

int sourceArrowIndex

targetArrowIndex

int targetArrowIndex

stateCellIndex

int stateCellIndex

stateCenters

javax.vecmath.Point2d[] stateCenters

tempVector2d

javax.vecmath.Vector2d tempVector2d

dimension

java.awt.Dimension dimension

initiate

boolean initiate

tempHeight

double tempHeight

tempWidth

double tempWidth

Package com.yobotics.simulationconstructionset.util.tracks

Class com.yobotics.simulationconstructionset.util.tracks.TrackGroundContactModel extends java.lang.Object implements Serializable

serialVersionUID: 7659055431615061425L

Serialized Fields

points

TrackGroundContactPoint[] points

baseModel

GroundContactModel baseModel

Class com.yobotics.simulationconstructionset.util.tracks.TrackGroundContactPoint extends GroundContactPoint implements Serializable

serialVersionUID: -936610163728292801L

Serialized Fields

dx_track

DoubleYoVariable dx_track

dy_track

DoubleYoVariable dy_track

dz_track

DoubleYoVariable dz_track

Package us.ihmc.graphics3DAdapter.camera

Class us.ihmc.graphics3DAdapter.camera.CameraMountList extends java.lang.Object implements Serializable

serialVersionUID: 7819849315544602348L

Serialized Fields

mounts

java.util.ArrayList<E> mounts

Class us.ihmc.graphics3DAdapter.camera.JPanelCameraStreamer extends javax.swing.JPanel implements Serializable

serialVersionUID: -6832977971630763132L

Serialized Fields

bufferedImage

java.awt.image.BufferedImage bufferedImage

Class us.ihmc.graphics3DAdapter.camera.ScreenCapture extends java.lang.Object implements Serializable

serialVersionUID: 4267642643460511978L

Serialized Fields

bytesOut

byte[] bytesOut

height

int height

width

int width

location

javax.vecmath.Point3d location

rotation

javax.vecmath.Quat4d rotation

fov

float fov

Package us.ihmc.graphics3DAdapter.java3D.fromSCS

Class us.ihmc.graphics3DAdapter.java3D.fromSCS.OffScreen3DView extends java.lang.Object implements Serializable

Class us.ihmc.graphics3DAdapter.java3D.fromSCS.RangeSensor extends javax.media.j3d.Behavior implements Serializable

serialVersionUID: 1527848532106815689L

Serialized Fields

name

java.lang.String name

offsetTransform

javax.media.j3d.Transform3D offsetTransform

transformToMount

javax.media.j3d.Transform3D transformToMount

transformToSensor

javax.media.j3d.Transform3D transformToSensor

pickTool

com.sun.j3d.utils.picking.PickTool pickTool

rangeSensorPoint3d

javax.vecmath.Point3d rangeSensorPoint3d

tempVector3d

javax.vecmath.Vector3d tempVector3d

rangeSensorVector3d

javax.vecmath.Vector3d rangeSensorVector3d

rotationMatrix3d

javax.vecmath.Matrix3d rotationMatrix3d

panTiltTransform3D

javax.media.j3d.Transform3D panTiltTransform3D

tempTransform3D

javax.media.j3d.Transform3D tempTransform3D

criterion

javax.media.j3d.WakeupCriterion criterion

waitingOnPickResult

boolean waitingOnPickResult

mostRecentIntersection

javax.vecmath.Point3d mostRecentIntersection

mostRecentDistance

double mostRecentDistance

Class us.ihmc.graphics3DAdapter.java3D.fromSCS.YoCanvas3D extends javax.media.j3d.Canvas3D implements Serializable

serialVersionUID: -6487054500049695800L

Serialized Fields

overlayComponents

java.util.ArrayList<E> overlayComponents

takeScreenShot

boolean takeScreenShot

preRenderer

PreRenderer preRenderer

image

java.awt.image.BufferedImage image

Package us.ihmc.graphics3DAdapter.jme.context

Class us.ihmc.graphics3DAdapter.jme.context.PBOAwtPanel extends java.awt.Canvas implements Serializable

serialVersionUID: -8871753166643132265L

Serialized Fields

attachAsMain

boolean attachAsMain

img

java.awt.image.BufferedImage img

fb

com.jme3.texture.FrameBuffer fb

rm

com.jme3.renderer.RenderManager rm

viewPorts

java.util.ArrayList<E> viewPorts

strategy

java.awt.image.BufferStrategy strategy

hasNativePeer

java.util.concurrent.atomic.AtomicBoolean hasNativePeer

showing

java.util.concurrent.atomic.AtomicBoolean showing

repaintRequest

java.util.concurrent.atomic.AtomicBoolean repaintRequest

newWidth

int newWidth

newHeight

int newHeight

reshapeNeeded

java.util.concurrent.atomic.AtomicBoolean reshapeNeeded

lock

java.lang.Object lock

gpuToVram

int gpuToVram

vramToSys

int vramToSys

dataSize

int dataSize

Package us.ihmc.plotting

Class us.ihmc.plotting.Artifact extends java.lang.Object implements Serializable

serialVersionUID: -463773605470590581L

Serialized Fields

id

java.lang.String id

type

java.lang.String type

level

int level

color

java.awt.Color color

isVisible

boolean isVisible

showID

boolean showID

drawHistory

boolean drawHistory

recordHistory

boolean recordHistory

Class us.ihmc.plotting.BasicPlotter extends javax.swing.JPanel implements Serializable

serialVersionUID: -1504885485210316586L

Serialized Fields

artifactsChangedListeners

java.util.ArrayList<E> artifactsChangedListeners

backgroundImage

java.awt.image.BufferedImage backgroundImage

preferredSize

java.awt.Dimension preferredSize

artifacts

java.util.HashMap<K,V> artifacts

_Xcenter

int _Xcenter

_Ycenter

int _Ycenter

_Xoffset

double _Xoffset

_Yoffset

double _Yoffset

_scale

double _scale

_scaleFactor

double _scaleFactor

_origScale

double _origScale

_ullon

double _ullon

_ullat

double _ullat

_lrlon

double _lrlon

_lrlat

double _lrlat

_origRange

int _origRange

_orientation

int _orientation

_Xselected

double _Xselected

_Yselected

double _Yselected

SHOW_GRID_LINES

boolean SHOW_GRID_LINES

Class us.ihmc.plotting.Coordinate extends java.lang.Object implements Serializable

serialVersionUID: 6493703987669931932L

Serialized Fields

x

double x

y

double y

z

double z

unit

int unit

Class us.ihmc.plotting.jFreePlotUtility extends javax.swing.JFrame implements Serializable

serialVersionUID: 2986192525063918143L

Class us.ihmc.plotting.PlotGraph2d extends flanagan.plot.Plot implements Serializable

serialVersionUID: -3065301775465274196L

Serialized Fields

graphWidth

int graphWidth

graphHeight

int graphHeight

closeChoice

int closeChoice

window

javax.swing.JFrame window

Class us.ihmc.plotting.Plotter extends javax.swing.JPanel implements Serializable

serialVersionUID: 3113130298799362369L

Serialized Fields

artifactsChangedListeners

java.util.ArrayList<E> artifactsChangedListeners

SHOW_SELECTION

boolean SHOW_SELECTION

drawHistory

boolean drawHistory

updateDelayInMillis

long updateDelayInMillis

lastUpdate

long lastUpdate

backgroundImage

java.awt.image.BufferedImage backgroundImage

preferredSize

java.awt.Dimension preferredSize

artifacts

java.util.HashMap<K,V> artifacts

xCenter

int xCenter

yCenter

int yCenter

xOffset

double xOffset

yOffset

double yOffset

scale

double scale

scaleFactor

double scaleFactor

_ullon

double _ullon

_ullat

double _ullat

_lrlon

double _lrlon

_lrlat

double _lrlat

xSelected

double xSelected

ySelected

double ySelected

_orientation

int _orientation

_areaX1

double _areaX1

_areaY1

double _areaY1

_areaX2

double _areaX2

_areaY2

double _areaY2

_areaX1TEMP

double _areaX1TEMP

_areaY1TEMP

double _areaY1TEMP

buttonPressed

int buttonPressed

dragStartX

int dragStartX

dragStartY

int dragStartY

xOffsetStartOfDrag

double xOffsetStartOfDrag

yOffsetStartOfDrag

double yOffsetStartOfDrag

_listener

DoubleClickListener _listener

MAKING_POLYGON

boolean MAKING_POLYGON

polygonArtifact

PolygonArtifact polygonArtifact

overrideAutomaticInterval

boolean overrideAutomaticInterval

manualOverideInterval

double manualOverideInterval

Class us.ihmc.plotting.PlotterLegendPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: -8268027977270506164L

Serialized Fields

artifacts

java.util.ArrayList<E> artifacts

Class us.ihmc.plotting.PlotterPanel extends javax.swing.JPanel implements Serializable

serialVersionUID: 4697277324924209439L

Serialized Fields

plotter

Plotter plotter

eventTA

javax.swing.JTextArea eventTA

plotMovement

boolean plotMovement

robotCentric

boolean robotCentric

gpsRB

javax.swing.JRadioButtonMenuItem gpsRB

recenterBtn

javax.swing.JButton recenterBtn

twoPlaceDecimalFormatter

java.text.DecimalFormat twoPlaceDecimalFormatter

Class us.ihmc.plotting.PointAndLinePlotter extends javax.swing.JPanel implements Serializable

serialVersionUID: 3112685871773037198L

Serialized Fields

DEFAULT_OVAL_SIZE

int DEFAULT_OVAL_SIZE

listOfPoints

java.util.ArrayList<E> listOfPoints

listOfColors

java.util.ArrayList<E> listOfColors

listOfOvalSizes

java.util.ArrayList<E> listOfOvalSizes

width

int width

height

int height

xScale

double xScale

yScale

double yScale

xMin

double xMin

xMax

double xMax

yMin

double yMin

yMax

double yMax

squareAxes

boolean squareAxes

initialized

boolean initialized

Class us.ihmc.plotting.Pose extends Coordinate implements Serializable

serialVersionUID: 3781748456290298303L

Serialized Fields

roll

double roll

pitch

double pitch

yaw

double yaw

Package us.ihmc.plotting.shapes

Class us.ihmc.plotting.shapes.ARDroneArtifact extends Artifact implements Serializable

serialVersionUID: -7196775480859274435L

Serialized Fields

_pose

Pose _pose

propellerOffset

double propellerOffset

noseOffset

double noseOffset

width

double width

length

double length

Class us.ihmc.plotting.shapes.CenteredImageIconArtifact extends Artifact implements Serializable

serialVersionUID: 8946412004186672487L

Serialized Fields

imageIcon

javax.swing.ImageIcon imageIcon

Class us.ihmc.plotting.shapes.CircleArtifact extends Artifact implements Serializable

serialVersionUID: -8129731194060916363L

Serialized Fields

x

double x

y

double y

diameter

double diameter

fill

boolean fill

Class us.ihmc.plotting.shapes.DroneArtifact extends Artifact implements Serializable

serialVersionUID: -7196775480859274435L

Serialized Fields

_pose

Pose _pose

width

double width

length

double length

Class us.ihmc.plotting.shapes.LineArtifact extends Artifact implements Serializable

serialVersionUID: -4292453853922762342L

Serialized Fields

point1

javax.vecmath.Point2d point1

point2

javax.vecmath.Point2d point2

lineThickness

int lineThickness

Class us.ihmc.plotting.shapes.MarkerArtifact extends Artifact implements Serializable

Serialized Fields

location

javax.vecmath.Point2d location

offset

javax.vecmath.Point2d offset

range

double range

bearing

double bearing

edgeLength

double edgeLength

Class us.ihmc.plotting.shapes.PioneerRobotArtifact extends Artifact implements Serializable

serialVersionUID: -7196775480859274435L

Serialized Fields

_pose

Pose _pose

width

double width

length

double length

Class us.ihmc.plotting.shapes.PointArtifact extends Artifact implements Serializable

serialVersionUID: -1676323503716482842L

Serialized Fields

_sonarHistory

java.util.Vector<E> _sonarHistory

_historyLength

int _historyLength

historyColor

java.awt.Color historyColor

_medianFilterSize

int _medianFilterSize

_meanFilterSize

int _meanFilterSize

size

int size

_startTime

long _startTime

Class us.ihmc.plotting.shapes.PolygonArtifact extends Artifact implements Serializable

serialVersionUID: -1874963815283452026L

Serialized Fields

points

java.util.ArrayList<E> points

FILL_POLYGON

boolean FILL_POLYGON

Class us.ihmc.plotting.shapes.PolyLine extends Artifact implements Serializable

serialVersionUID: -8244299057847713312L

Serialized Fields

points

java.util.ArrayList<E> points

lineThickness

int lineThickness

Class us.ihmc.plotting.shapes.RobotArtifact extends Artifact implements Serializable

serialVersionUID: 874940514060462114L

Serialized Fields

_pose

Pose _pose

width

double width

Class us.ihmc.plotting.shapes.ShapeArtifact extends Artifact implements Serializable

serialVersionUID: 2446850336045691305L

Serialized Fields

pose

Pose pose

height

double height

width

double width

Class us.ihmc.plotting.shapes.TextArtifact extends Artifact implements Serializable

serialVersionUID: 4004880709697051705L

Serialized Fields

x1

double x1

y1

double y1

text

java.lang.String text

font

java.awt.Font font

xPixelOffset

int xPixelOffset

yPixelOffset

int yPixelOffset

Package us.ihmc.plotting3d

Class us.ihmc.plotting3d.Plotter3D extends javax.swing.JPanel implements Serializable

Serialized Fields

artifactsChangedListeners

java.util.ArrayList<E> artifactsChangedListeners

preferredSize

java.awt.Dimension preferredSize

artifacts

java.util.HashMap<K,V> artifacts

camera

VirtualCamera camera

plotterWorld

PlotterWorld plotterWorld

Package us.ihmc.plotting3d.artifacts

Class us.ihmc.plotting3d.artifacts.Arrow3DArtifact extends Artifact3D implements Serializable

Serialized Fields

point1

javax.vecmath.Point3d point1

point3

javax.vecmath.Point3d point3

lineThickness

float lineThickness

previousGraphics

javax.media.j3d.BranchGroup previousGraphics

Class us.ihmc.plotting3d.artifacts.Box3DArtifact extends Artifact3D implements Serializable

Serialized Fields

box

javax.media.j3d.Shape3D box

position

FramePose position

Class us.ihmc.plotting3d.artifacts.Line3DArtifact extends Artifact3D implements Serializable

Serialized Fields

point1

javax.vecmath.Point3d point1

point2

javax.vecmath.Point3d point2

lineThickness

float lineThickness

previousGraphics

javax.media.j3d.BranchGroup previousGraphics

Class us.ihmc.plotting3d.artifacts.Model3DArtifact extends Artifact3D implements Serializable

Serialized Fields

pose

FramePose pose

shape

javax.media.j3d.BranchGroup shape

trans

javax.media.j3d.Transform3D trans

Class us.ihmc.plotting3d.artifacts.Point3DArtifact extends Artifact3D implements Serializable

Serialized Fields

point1

javax.vecmath.Point3d point1

pointRadius

float pointRadius

graphicsDrawn

boolean graphicsDrawn

Package us.ihmc.robotSide

Class us.ihmc.robotSide.SideDependentList extends java.util.EnumMap<RobotSide,V> implements Serializable

serialVersionUID: -6514328471068877058L


Package us.ihmc.utilities

Class us.ihmc.utilities.SimpleLRUCache extends java.util.LinkedHashMap<K,V> implements Serializable

serialVersionUID: -8670808345162245362L

Serialized Fields

maxEntries

int maxEntries

Package us.ihmc.utilities.calibration

Class us.ihmc.utilities.calibration.OrderedProperties extends java.util.Properties implements Serializable

serialVersionUID: -6637558671519947162L


Package us.ihmc.utilities.camera

Class us.ihmc.utilities.camera.ImageViewer extends javax.swing.JPanel implements Serializable

Serialized Fields

_image

java.awt.Image _image

Class us.ihmc.utilities.camera.StereoImageViewer extends javax.swing.JPanel implements Serializable

Serialized Fields

_leftImage

java.awt.Image _leftImage

_rightImage

java.awt.Image _rightImage

Package us.ihmc.utilities.dataStructures.hyperCubeTree

Class us.ihmc.utilities.dataStructures.hyperCubeTree.DimensionalityMismatchException extends java.lang.RuntimeException implements Serializable

serialVersionUID: -3743668297374577032L

Class us.ihmc.utilities.dataStructures.hyperCubeTree.LeafNotFoundException extends java.lang.Exception implements Serializable

serialVersionUID: 4551542214507211359L


Package us.ihmc.utilities.exeptions

Class us.ihmc.utilities.exeptions.NoConvergenceException extends java.lang.Exception implements Serializable

serialVersionUID: 6212719102444264616L


Package us.ihmc.utilities.fixedPointRepresentation

Class us.ihmc.utilities.fixedPointRepresentation.OutsideSerializableValuesException extends java.lang.Exception implements Serializable

serialVersionUID: -6683601571193124194L

Serialized Fields

dataType

java.lang.String dataType

value

double value

min

double min

max

double max

Package us.ihmc.utilities.gui

Class us.ihmc.utilities.gui.AbstractMultiButtonAction extends javax.swing.AbstractAction implements Serializable

serialVersionUID: 5549057675462205945L

Serialized Fields

buttons

java.util.ArrayList<E> buttons

Class us.ihmc.utilities.gui.GUIMessagePanel extends javax.swing.JPanel implements Serializable

serialVersionUID: 627707062057513407L

Serialized Fields

name

java.lang.String name

textArea

javax.swing.JTextArea textArea

jScrollPane

javax.swing.JScrollPane jScrollPane

quiet

boolean quiet

Class us.ihmc.utilities.gui.MultiButtonDeselectionAction extends AbstractMultiButtonAction implements Serializable

serialVersionUID: 6676720724283758238L

Class us.ihmc.utilities.gui.MultiButtonSelectionAction extends AbstractMultiButtonAction implements Serializable

serialVersionUID: -6522689157942679644L

Class us.ihmc.utilities.gui.MultiButtonSelectionDeselectionAction extends AbstractMultiButtonAction implements Serializable

serialVersionUID: 3282636785189524215L

Serialized Fields

enableAll

java.lang.Boolean enableAll

menuItem

javax.swing.JMenuItem menuItem

enableAllText

java.lang.String enableAllText

disableAllText

java.lang.String disableAllText

Package us.ihmc.utilities.io.streamingData

Class us.ihmc.utilities.io.streamingData.SimpleStreamedData extends java.lang.Object implements Serializable

serialVersionUID: 8313773654191190644L

Serialized Fields

value

int value

Package us.ihmc.utilities.keyboardAndMouse

Class us.ihmc.utilities.keyboardAndMouse.RepeatingReleasedEventsFixer.RepostedKeyEvent extends java.awt.event.KeyEvent implements Serializable


Package us.ihmc.utilities.lidar.polarLidar.geometry

Class us.ihmc.utilities.lidar.polarLidar.geometry.LIDARScanDefinition extends java.util.ArrayList<Ray3d> implements Serializable

serialVersionUID: 6984600377583458326L


Package us.ihmc.utilities.listeners

Class us.ihmc.utilities.listeners.GraphicAttributes extends GraphicAttributesSimple implements Serializable

serialVersionUID: -1327531779881863233L

Serialized Fields

appearance

javax.media.j3d.Appearance appearance

Class us.ihmc.utilities.listeners.GraphicAttributesSimple extends java.lang.Object implements Serializable

serialVersionUID: 6124494086397195350L

Serialized Fields

name

java.lang.String name

color

double[] color

diameter

double diameter

Class us.ihmc.utilities.listeners.TextConsole extends javax.swing.JPanel implements Serializable

serialVersionUID: -2268921544766417458L

Serialized Fields

name

javax.swing.JLabel name

jScrollPane

javax.swing.JScrollPane jScrollPane

jTextArea

javax.swing.JTextArea jTextArea

contents

java.lang.String contents

Package us.ihmc.utilities.listeners.messages

Class us.ihmc.utilities.listeners.messages.ResetAllMessage extends java.lang.Object implements Serializable

serialVersionUID: -8900227512423006334L

Class us.ihmc.utilities.listeners.messages.ResetLineMessage extends java.lang.Object implements Serializable

serialVersionUID: 1581823532932449719L

Serialized Fields

key

java.lang.String key

Class us.ihmc.utilities.listeners.messages.ResetPointMessage extends java.lang.Object implements Serializable

serialVersionUID: 2404093789631430841L

Serialized Fields

key

java.lang.String key

Class us.ihmc.utilities.listeners.messages.ResetVectorMessage extends java.lang.Object implements Serializable

serialVersionUID: -2381426688034131771L

Serialized Fields

key

java.lang.String key

Class us.ihmc.utilities.listeners.messages.SetLineInWorldMessage extends SetVectorInWorldMessage implements Serializable

serialVersionUID: 4798579801532269898L

Class us.ihmc.utilities.listeners.messages.SetPointInWorldMessage extends java.lang.Object implements Serializable

serialVersionUID: 6703999863973949638L

Serialized Fields

key

java.lang.String key

x

double x

y

double y

z

double z

Class us.ihmc.utilities.listeners.messages.SetVectorInWorldMessage extends java.lang.Object implements Serializable

serialVersionUID: 877671858335364347L

Serialized Fields

key

java.lang.String key

xStart

double xStart

yStart

double yStart

zStart

double zStart

xEnd

double xEnd

yEnd

double yEnd

zEnd

double zEnd

Class us.ihmc.utilities.listeners.messages.StringMessage extends java.lang.Object implements Serializable

serialVersionUID: 7175508360580863980L

Serialized Fields

string

java.lang.String string

Class us.ihmc.utilities.listeners.messages.TickMessage extends java.lang.Object implements Serializable

serialVersionUID: 628913406212335278L


Package us.ihmc.utilities.math.geometry

Class us.ihmc.utilities.math.geometry.CenterOfMassReferenceFrame extends ReferenceFrame implements Serializable

serialVersionUID: 97944957592733289L

Serialized Fields

centerOfMassCalculator

CenterOfMassCalculator centerOfMassCalculator

centerOfMass

FramePoint centerOfMass

centerOfMassVector3d

javax.vecmath.Vector3d centerOfMassVector3d

Class us.ihmc.utilities.math.geometry.ConvexPolygon2d.FewerThanOnePointException extends java.lang.RuntimeException implements Serializable

serialVersionUID: -2801507838689168252L

Class us.ihmc.utilities.math.geometry.FrameGeometry2dPlotter extends javax.swing.JPanel implements Serializable

serialVersionUID: 2505175418803166784L

Serialized Fields

testPoints

java.util.ArrayList<E> testPoints

polygonToCheckInside

FrameConvexPolygon2d polygonToCheckInside

frameLineGroups

java.util.LinkedHashMap<K,V> frameLineGroups

framePointGroups

java.util.LinkedHashMap<K,V> framePointGroups

frameConvexPolygonGroups

java.util.LinkedHashMap<K,V> frameConvexPolygonGroups

frameLineSegmentGroups

java.util.LinkedHashMap<K,V> frameLineSegmentGroups

xCenter

double xCenter

yCenter

double yCenter

scale

double scale

pointPixels

int pointPixels

lastMousePressX

double lastMousePressX

lastMousePressY

double lastMousePressY

buttonPressed

int buttonPressed

dragStartX

int dragStartX

dragStartY

int dragStartY

Class us.ihmc.utilities.math.geometry.FrameGeometryTestFrame extends javax.swing.JFrame implements Serializable

serialVersionUID: 1211077223435215178L

Serialized Fields

frameGeometry2dPlotter

FrameGeometry2dPlotter frameGeometry2dPlotter

goodButton

us.ihmc.utilities.math.geometry.FrameGeometryTestFrame.GoodButton goodButton

badButton

us.ihmc.utilities.math.geometry.FrameGeometryTestFrame.BadButton badButton

Class us.ihmc.utilities.math.geometry.FramePoint extends java.lang.Object implements Serializable

serialVersionUID: -4831948077397801540L

Serialized Fields

referenceFrame

ReferenceFrame referenceFrame

point

javax.vecmath.Point3d point

name

java.lang.String name

temporaryTransformToDesiredFrame

javax.media.j3d.Transform3D temporaryTransformToDesiredFrame

Class us.ihmc.utilities.math.geometry.FramePoint2d extends java.lang.Object implements Serializable

serialVersionUID: -1287148635726098768L

Serialized Fields

temporaryTransformToDesiredFrame

javax.media.j3d.Transform3D temporaryTransformToDesiredFrame

transformedPoint

javax.vecmath.Point3d transformedPoint

name

java.lang.String name

point

javax.vecmath.Point2d point

referenceFrame

ReferenceFrame referenceFrame

Class us.ihmc.utilities.math.geometry.FrameVector extends java.lang.Object implements Serializable

serialVersionUID: -4475317718392284548L

Serialized Fields

referenceFrame

ReferenceFrame referenceFrame

vector

javax.vecmath.Vector3d vector

name

java.lang.String name

temporaryTransformToDesiredFrame

javax.media.j3d.Transform3D temporaryTransformToDesiredFrame

Class us.ihmc.utilities.math.geometry.InsufficientDataException extends java.lang.Exception implements Serializable

serialVersionUID: -7197928415954111947L

Class us.ihmc.utilities.math.geometry.MidFrameZUpFrame extends ReferenceFrame implements Serializable

serialVersionUID: -2229169827166093475L

Serialized Fields

parentZUpFrame

ReferenceFrame parentZUpFrame

frameOne

ReferenceFrame frameOne

frameTwo

ReferenceFrame frameTwo

Class us.ihmc.utilities.math.geometry.NonProperRigidTransformException extends java.lang.RuntimeException implements Serializable

serialVersionUID: -3384043945185991333L

Class us.ihmc.utilities.math.geometry.OrientationFrame extends ReferenceFrame implements Serializable

serialVersionUID: 6465943952628127959L

Serialized Fields

frameOrientation

FrameOrientation frameOrientation

Class us.ihmc.utilities.math.geometry.OriginAndPointFrame extends ReferenceFrame implements Serializable

serialVersionUID: -3583775854419464525L

Serialized Fields

origin

FramePoint origin

positionToPointAt

FramePoint positionToPointAt

xAxis

javax.vecmath.Vector3d xAxis

yAxis

javax.vecmath.Vector3d yAxis

zAxis

javax.vecmath.Vector3d zAxis

rotationMatrix

javax.vecmath.Matrix3d rotationMatrix

originVector

javax.vecmath.Vector3d originVector

Class us.ihmc.utilities.math.geometry.PointXAxisAtPositionFrame extends ReferenceFrame implements Serializable

serialVersionUID: -3583775854419464525L

Serialized Fields

positionToPointAt

FramePoint positionToPointAt

xAxis

javax.vecmath.Vector3d xAxis

yAxis

javax.vecmath.Vector3d yAxis

zAxis

javax.vecmath.Vector3d zAxis

rotationMatrix

javax.vecmath.Matrix3d rotationMatrix

Class us.ihmc.utilities.math.geometry.Pose2dReferenceFrame extends ReferenceFrame implements Serializable

serialVersionUID: 1559362743221742457L

Serialized Fields

originPose

FramePose2d originPose

Class us.ihmc.utilities.math.geometry.PoseReferenceFrame extends ReferenceFrame implements Serializable

serialVersionUID: 1559362743221742457L

Serialized Fields

originPose

FramePose originPose

Class us.ihmc.utilities.math.geometry.ReferenceFrame extends java.lang.Object implements Serializable

serialVersionUID: 9129810880579453658L

Serialized Fields

frameName

java.lang.String frameName

parentFrame

ReferenceFrame parentFrame

framesStartingWithRootEndingWithThis

ReferenceFrame[] framesStartingWithRootEndingWithThis

transformToParent

javax.media.j3d.Transform3D transformToParent

transformToRootID

long transformToRootID

transformToRoot

javax.media.j3d.Transform3D transformToRoot

isBodyCenteredFrame

boolean isBodyCenteredFrame

isWorldFrame

boolean isWorldFrame

isZupFrame

boolean isZupFrame

temporaryTransform1

SerializableTransform3D temporaryTransform1

Class us.ihmc.utilities.math.geometry.ReferenceFrameMismatchException extends java.lang.RuntimeException implements Serializable

serialVersionUID: -2379052247493923182L

Class us.ihmc.utilities.math.geometry.SerializableTransform3D extends javax.media.j3d.Transform3D implements Serializable

serialVersionUID: 996998870074254456L

Class us.ihmc.utilities.math.geometry.TransformReferenceFrame extends ReferenceFrame implements Serializable

serialVersionUID: -6741627181585210414L

Serialized Fields

transform3D

javax.media.j3d.Transform3D transform3D

Class us.ihmc.utilities.math.geometry.TranslationFrame extends ReferenceFrame implements Serializable

serialVersionUID: 1279913371194996845L

Serialized Fields

translation

javax.vecmath.Vector3d translation

Class us.ihmc.utilities.math.geometry.TranslationReferenceFrame extends ReferenceFrame implements Serializable

serialVersionUID: -6741627181585210414L

Serialized Fields

originVector

FrameVector originVector

Class us.ihmc.utilities.math.geometry.XYPlaneFrom3PointsFrame extends ReferenceFrame implements Serializable

serialVersionUID: 8615028266128433328L

Serialized Fields

world

ReferenceFrame world

p1

FramePoint p1

p2

FramePoint p2

p3

FramePoint p3

rotation

javax.vecmath.Matrix3d rotation

eX

javax.vecmath.Vector3d eX

eY

javax.vecmath.Vector3d eY

eZ

javax.vecmath.Vector3d eZ

Class us.ihmc.utilities.math.geometry.ZUpFrame extends ReferenceFrame implements Serializable

serialVersionUID: 8615028266128433328L

Serialized Fields

euler

javax.vecmath.Vector3d euler

translation

javax.vecmath.Vector3d translation

worldFrame

ReferenceFrame worldFrame

origin

FramePoint origin

nonZUpToWorldRotation

javax.vecmath.Matrix3d nonZUpToWorldRotation

originPoint3d

javax.vecmath.Point3d originPoint3d

nonZUpToWorld

javax.media.j3d.Transform3D nonZUpToWorld

Package us.ihmc.utilities.math.overheadPath

Class us.ihmc.utilities.math.overheadPath.PoseDiscontinuityException extends java.lang.RuntimeException implements Serializable

serialVersionUID: -6023864470423527341L


Package us.ihmc.utilities.net.tcpServer

Class us.ihmc.utilities.net.tcpServer.DisconnectedException extends java.lang.Exception implements Serializable

serialVersionUID: -5157161728060838755L


Package us.ihmc.utilities.remote

Class us.ihmc.utilities.remote.IntegerPacket extends java.lang.Object implements Serializable

serialVersionUID: -214863275141788710L

Serialized Fields

contents

int contents

Class us.ihmc.utilities.remote.RemoteRequest extends java.lang.Object implements Serializable

serialVersionUID: -3338612762215398251L

Serialized Fields

methodName

java.lang.String methodName

parameters

java.util.Vector<E> parameters

Class us.ihmc.utilities.remote.StringPacket extends java.lang.Object implements Serializable

serialVersionUID: 413928572816648643L

Serialized Fields

contents

java.lang.String contents

Class us.ihmc.utilities.remote.TCPAddress extends java.lang.Object implements Serializable

serialVersionUID: -7494269102464437835L

Serialized Fields

host

java.lang.String host

port

int port

Class us.ihmc.utilities.remote.UnsupportedFormatException extends java.lang.Exception implements Serializable

serialVersionUID: 8845641123167087257L


Package us.ihmc.utilities.screwTheory

Class us.ihmc.utilities.screwTheory.OneDoFJointReferenceFrame extends ReferenceFrame implements Serializable

serialVersionUID: 1L

Class us.ihmc.utilities.screwTheory.PlanarJointReferenceFrame extends ReferenceFrame implements Serializable

serialVersionUID: 1179880149506811812L

Serialized Fields

rotation

double rotation

translation

javax.vecmath.Vector3d translation

Class us.ihmc.utilities.screwTheory.PrismaticJointReferenceFrame extends OneDoFJointReferenceFrame implements Serializable

serialVersionUID: -1982346476164458546L

Serialized Fields

axis

javax.vecmath.Vector3d axis

position

double position

tempTranslation

javax.vecmath.Vector3d tempTranslation

Class us.ihmc.utilities.screwTheory.RevoluteJointReferenceFrame extends OneDoFJointReferenceFrame implements Serializable

serialVersionUID: -1982346476164458546L

Serialized Fields

axis

javax.vecmath.Vector3d axis

angle

double angle

tempAxisAngle

javax.vecmath.AxisAngle4d tempAxisAngle

Class us.ihmc.utilities.screwTheory.SixDoFJointReferenceFrame extends ReferenceFrame implements Serializable

serialVersionUID: 8238436678986979988L

Serialized Fields

rotation

javax.vecmath.Quat4d rotation

translation

javax.vecmath.Vector3d translation

Package us.ihmc.utilities.test

Class us.ihmc.utilities.test.HumanAssistedTestFrame extends javax.swing.JFrame implements Serializable

serialVersionUID: -6270384898459053226L

Serialized Fields

goodButton

us.ihmc.utilities.test.HumanAssistedTestFrame.GoodButton goodButton

badButton

us.ihmc.utilities.test.HumanAssistedTestFrame.BadButton badButton