| __DerivativeWiringConf | Configuration Object for DerivativeWiring | 
| _ComponentConf | |
| _RandGen | |
| AbstractController | Abstract class (interface) for robot controller | 
| AbstractControllerAdapter | Abstract adapter class (interface) for robot controller | 
| AbstractGround | |
| AbstractIAFController | Abstract class (interface) for robot controller that uses an integrate and fire neuron model | 
| AbstractIAFControllerConf | |
| AbstractMeasure | Class used by StatisticTools | 
| AbstractModel | Abstract class (interface) for a model that can be used by a controller | 
| AbstractMultiController | Abstract class (interface) for using multiple controller | 
| AbstractObstacle | Abstract class (interface) for obstacles | 
| AbstractRobot | Abstract class (interface) for robot in general | 
| AbstractTrackSection | Abstract class (interface) for obstacles | 
| AbstractWiring | Abstract wiring-object between controller and robot | 
| AddSensors2RobotAdapter | Robot adapter to add sensors and also motors to robots without the need to modify the robot itself | 
| Agent | The Agent contains a controller, a robot and a wiring, which connects robot and controller | 
| AngularMotor | Abstract angular motor class | 
| AngularMotor1Axis | Angular motor for OneAxisJoints | 
| AngularMotor2Axis | Angular motor for TwoAxisJoints | 
| AngularMotor3AxisEuler | Angular motor for Ball Joints with Euler control | 
| AngularMotorNAxis | Angular motor for arbitrary Joints with custom axis (up to 3) | 
| Arm | |
| Arm2Segm | |
| Arm2SegmConf | |
| ArmConf | |
| AtomComponent | AtomComponent | 
| AtomComponent::connectionAddition | |
| AtomConf | |
| Axis | |
| AxisOrientationSensor | Class for sensing the axis orienation of a primitive (robot) | 
| BackCaller | Class prototype which provides functions to handle callbackable classes | 
| BallJoint | |
| Barrel2Masses | A barrel-like robot with 2 internal masses, which can slide on their orthogonal axes | 
| Barrel2Masses2nd | A barrel-like robot with 2 internal masses, which can slide on their orthogonal axes | 
| Base | |
| BasicController | Class for robot controller is based on InvertMotorNStep | 
| BasicControllerConf | |
| BoundingShape | Class for reading bounding shape description files (.bbox) and to create appropriate geoms | 
| Box | Box primitive | 
| Bumper | |
| Callbackable | Interface class for a class which wants to be callback on a certain action | 
| CameraHandle | Class which holds all data used by CameraManipulators | 
| CameraManipulator | CameraManipulator is a MatrixManipulator which provides a flying camera updating of the camera position & orientation | 
| CameraManipulatorFollow | CameraManipulatorFollow is a MatrixManipulator which provides Flying simulator-like updating of the camera position & orientation | 
| CameraManipulatorRace | CameraManipulatorRace is a MatrixManipulator which provides Flying simulator-like updating of the camera position & orientation | 
| CameraManipulatorTV | CameraManipulatorTV is a MatrixManipulator which provides Flying simulator-like updating of the camera position & orientation | 
| Capsule | Capsule primitive | 
| CaterPillar | This is a class, which models a snake like robot | 
| CaterPillarConf | |
| ClassicReinforce | Class for robot controller using several feedforward networks (satelite) and one selforg controller | 
| ClassicReinforceConf | |
| Clock | A cross-platform clock class inspired by the Timer classes in Ogre (http://www.ogre3d.org) | 
| ClosedPlayground | |
| Color | |
| ColorNormalNoise | Like ColorUniformNoise but averaging over normal distributed noise instead | 
| ColorUniformNoise | Generated colored noise. This is obtained by using time average of uniform distributed noise | 
| COMMAND | |
| ComplexMeasure | |
| ComplexPlayground | Playground that uses xfig file with polylines linetype 0 is normal line linetype 1 is border thickness is used as well, thickness is multiplied with wallthickness | 
| Component | This is the abstract base class of the component system | 
| Component::componentConnection | This is the structure of one connection between two components | 
| Configurable | Abstact class for configurable objects | 
| Configurable::matchId | Nice predicate function for finding by ID | 
| Cylinder | Cylinder primitive | 
| DefaultCaterPillar | This is a class, which models a snake like robot | 
| DefaultWheelie | This is a class, which models a snake like robot | 
| DegreeSegment | Class for degree segments | 
| DerivativeWiring | Implements a wiring (between controller and robot) which includes the first and second derivative of the original robot sensor values | 
| DiscreteControllerAdapter | Adapter class for robot controller | 
| Discretesizable | Abstact class for discretesizable controllers | 
| Discretisizer | Use this class to get discrete values | 
| Discus | A spherical robot with 3 internal masses, which can slide on their orthogonal axes | 
| DiscusConf | Configuration object for the Discus robot | 
| DoubleRandomStrategy | This class create a IValue (TemplateValue with type double) and initialize it with an random double value | 
| drand48_data | |
| DummyMotor | |
| DummyPrimitive | Dummy Primitive which returns 0 for geom and body | 
| EliteSelectStrategy | This class makes a elite select and bring only the best individual in the next generation | 
| Elman | Multilayer Neural Network with context neurons (after Elman and Jordan) Example of 2 hidden layer network with both, elman and jordan context units | 
| EuclidicDistanceFitnessStrategy | This fitness strategy calculate from all double gens (IValue<double>) the euclidic distance to zero | 
| ExtreamTestFitnessStrategy | An example implementation and a extreme test for gen | 
| FeedbackWiring | Implements essentionally a one to one wiring with feedback connections | 
| FeedForwardNN | Abstract class (interface) for feed forward rate based neural networks | 
| FFNNController | Class for robot controller with a fixed neural network | 
| FixedJoint | |
| FixGenerationSizeStrategy | This class implements the generation size strategy with a fix value which is over the constructor given | 
| FixMutationFactorStrategy | This strategy implementation return a fix value for the mutation factor | 
| ForcedSphere | |
| ForcedSphereConf | |
| Formel1 | Robot that looks like a Nimm 2 Bonbon :-) 4 wheels and a capsule like body | 
| FourWheeled | Robot is based on nimm4 with 4 wheels and a capsule like body | 
| FourWheeledConf | |
| Gen | The Gen class | 
| GenContext | The GenContext class | 
| Generation | The Generation class | 
| GenPrototype | The GenPrototype class | 
| geomPairHash | |
| GlobalData | Data structure holding all essential global information | 
| Hand | Artificial Hand | 
| HandConf | |
| HeightField | Height field primitive | 
| Hinge2Joint | |
| HingeJoint | |
| HomeokinBase | Abstract class (interface) for robot controller that use are based on the homeokinetic prinziple | 
| HUDStatisticsManager | Manages all the stuff displaying statistics on the graphics window | 
| HUDStatisticsManager::WindowStatistic | Nested class WindowStatistic, which puts the measure and the graphics text together | 
| HurlingSnake | Hurling snake is a string a beats | 
| ieee754_double | |
| IException | |
| IFitnessStrategy | The interface for the fitness strategy of an individual | 
| IGenerationSizeStrategy | This interface is to specify how big the next generation should be | 
| ImagePPM | |
| IMeasure | Class used by StatisticTools | 
| IMutationFactorStrategy | This is a interface for a strategy, which is used by ValueMutationStrategy | 
| IMutationStrategy | This interface gives the structur for the mutation of a gen | 
| Indices | |
| Individual | This class represent one individual of the complete gen | 
| Inspectable | Interface for inspectable objects | 
| Inspectable::IConnection | |
| Inspectable::ILayer | |
| Inspectable::matchName | Nice predicate function for finding a Layer with its vectorname | 
| InspectableProxy | This class is a proxy for the inspectable class | 
| InvertableModel | Abstract class (interface) for invertable models | 
| InvertController | Abstract class (interface) for robot controller that use direct matrix inversion and simple one layer networks | 
| InvertedFitnessStrategy | This strategy calculate the invert to a other strategy | 
| InvertMotorBigModel | Class for robot controller is based on InvertMotorNStep | 
| InvertMotorBigModelConf | |
| InvertMotorController | Extended HomeokinBase class (still abstract) for robot controller work in motorspace and use possibly many steps and adaptive learning rate | 
| InvertMotorNStep | Class for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks) | 
| InvertMotorNStepConf | |
| InvertMotorSpace | Class for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks) | 
| InvertNChannelController | Class for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks) | 
| iparampair | |
| IRandomStrategy | This interface is to create a random IValue | 
| IRSensor | Class for IR sensors | 
| ISelectStrategy | This interface is for a select strategy of the generation class | 
| IValue | This class is a interface for a value which is part of a gen | 
| Joint | |
| Layer | |
| Matrix | Matrix type | 
| MeasureAdapter | This is a passive controller adapter who is passive and can handle AbstractMeasures | 
| Mediator | |
| MediatorCollegue | |
| MediatorEvent | The default MediatorEvent holds no information, the implementation of the mediator should implement a derived version of the MediatorEvent | 
| Mesh | Mesh primitive | 
| MeshGround | |
| MeshObstacle | |
| MotionBlurDrawCallback | Class that enables motion blur for the scenegraph should be called in the main simulation loop | 
| MotionBlurOperation | Class that enables motion blur for the scenegraph should be called in the main simulation loop | 
| Motor | Abstact base class for attachable motors | 
| MotorNoiseWiring | Implements a one to one wiring that adds noise to the motor signals (the sensors will get no noise) | 
| MoveEarthySkyWithEyePointTransform | |
| MultiLayerFFNN | Multi layer neural network with configurable activation functions | 
| MuscledArm | |
| MuscledArmConf | |
| MutualInformationController | This is a controller who is passive at the moment, that means, he will not generate any motor values | 
| MyRobot | |
| NetUpdate | Updates for network | 
| Nimm2 | Robot that looks like a Nimm 2 Bonbon :-) 2 wheels and a cylinder like body | 
| Nimm2Conf | |
| Nimm4 | Robot that looks like a Nimm 2 Bonbon :-) 4 wheels and a capsule like body | 
| NoiseGenerator | Interface and basic class for noise generator | 
| NoNoise | Generates no noise | 
| OctaPlayground | |
| OdeAgent | Specialised agent for ode robots | 
| OdeConfig | The class $name holds the configurable parameters of the simulation environment | 
| OdeHandle | Data structure for accessing the ODE | 
| OdeRobot | Abstract class for ODE robots | 
| One2OneWiring | Implements one to one wireing of robot sensors to inputs of the controller and controller outputs to robot motors | 
| OneActiveMultiPassiveController | Class (interface) for using multiple controller, the first one is the active one, which generates motor values | 
| OneAxisJoint | |
| OneAxisServo | General servo motor to achieve position control | 
| OneAxisServoCentered | General servo motor to achieve position control with zero position centered | 
| OneAxisServoVel | General servo motor to achieve position control that that internally controls the velocity of the motor (much more stable) with centered zero position | 
| OneLayerFFNN | Simple one layer neural network with configurable activation function | 
| OSGBox | Graphical box | 
| OSGBoxTex | Graphical box with Textures | 
| OSGCapsule | Graphical capsule (a cylinder with round ends) | 
| OSGCylinder | Graphical cylinder | 
| OSGDummy | A dummy graphical object, which has no representation in the graphical world | 
| OsgHandle | Data structure for accessing the ODE | 
| OSGHeightField | Graphical HeightField | 
| OSGMainLoop | |
| OSGMesh | Graphical Mesh or arbitrary OSG model | 
| OSGPlane | Graphical plane (represented as a large thin box, because OSG does not draw planes) | 
| OSGPrimitive | Interface class for graphic primitives like spheres, boxes, and meshes, which can be drawn by OSG | 
| OSGSphere | Graphical sphere | 
| ParallelTask | A base class for parallel task classes which are defined by a set of macros | 
| ParallelTaskManager | A singleton class to manage parallel code tasks | 
| parampair | |
| PassiveBox | (Passive) box as obstacle | 
| PassiveCapsule | (Passive) capsule as obstacle | 
| PassiveMesh | (Passive) mesh as obstacle | 
| PassiveSphere | (Passive) sphere as obstacle | 
| PID | |
| Plane | Plane primitive | 
| PlatformThreadObjects | |
| PlattfussSchlange | This is a class, which models a snake like robot with flat ends and a big body in the middle | 
| Playground | |
| PlotOption | This class contains options for the use of an external plot utility like guilogger or neuronviz or just simply file output | 
| PlotOption::matchMode | Nice predicate function for finding by mode | 
| PlotOptionEngine | |
| PolyLine | |
| Pos | |
| Position | |
| Primitive | Interface class for primitives represented in the physical and graphical world | 
| PrimitiveComponent | Component consisting of one Primitive | 
| ProfileBlock | A simple data structure representing a single timed block of code | 
| Profiler | A singleton class that manages timing for a set of profiling blocks | 
| QLearning | Implements QLearning | 
| RaceGround | |
| RandomSelectStrategy | This class makes a select by randomized comparison of one individual of the old generation with a random number | 
| Ray | Ray primitive The actual visual representation can have different length than the ray object | 
| RaySensor | Abstract class for Ray-based sensors | 
| RaySensorBank | Class for a bank (collection) of ray sensors | 
| RelativePositionSensor | Class for relative position sensing | 
| ReplayController | Controller that replays a file | 
| ReplayRobot | |
| repSlider | |
| RESTORE_GA_GENE | |
| RESTORE_GA_GENERATION | |
| RESTORE_GA_HEAD | |
| RESTORE_GA_INDIVIDUAL | |
| RESTORE_GA_TEMPLATE | |
| RobotComponent | This is a special class of the component system | 
| Schlange | This is a class, which models a snake like robot | 
| SchlangeConf | |
| SchlangeForce | This is a class, which models a snake like robot | 
| SchlangeServo | This is a class, which models a snake like robot | 
| SchlangeServo2 | This is a class, which models a snake like robot | 
| SchlangeVelocity | This is a class, which models a snake like robot | 
| select_all | |
| select_firsthalf | |
| select_from_to | Select sensors in the range  
 (inclusively)  | 
| select_predicate | Predicate to select sensors | 
| SelectiveOne2OneWiring | Implements a selective one to one wireing of robot sensors to inputs of the controller and controller outputs to robot motors | 
| Sensor | Abstract class for sensors that have no specific position at the robots skeleton | 
| SfitnessEliteStrategyStruct | Help structur to sort the individual by the fitness values | 
| ShadowDrawCallback | |
| ShortCircuit | |
| SimpleComponent | A simple component is a special form of component | 
| Simulation | |
| SimulationTask | |
| SimulationTaskHandle | Struct which holds all structural data for the simulations | 
| SimulationTaskSupervisor | |
| SineController | Class for robot control with sine, sawtooth and impuls | 
| SineWhiteNoise | Sine wave noise. Produces a 90 degree phase shifted sine wave or white noise | 
| SingletonGenAlgAPI | This is a facade for the gen | 
| SingletonGenEngine | This is the engine of the gen | 
| SingletonGenFactory | This is the factory for the class Gen | 
| SingletonIndividualFactory | This is a factory for the individual class | 
| SliderJoint | |
| SliderWheelie | This is a class, which models an annular robot | 
| SliderWheelieConf | |
| SOM | Self-organised map class | 
| Sound | Object that represents a sound signal in the simulator | 
| Sound::older_than | Nice predicate function for finding old sound signals | 
| SoundSensor | Sound sensor with possible direction and frequency detection and also distance dependence | 
| SparseArray | |
| SparseArray::ArrayElement | |
| SparseMatrix | Sparse matrix which uses an HashTable first (fast implemented) version | 
| Speaker | |
| SpeedSensor | Class for speed sensing of robots | 
| Sphere | Sphere primitive | 
| Sphererobot | This is a class, which models a snake like robot | 
| Sphererobot3Masses | A spherical robot with 3 internal masses, which can slide on their orthogonal axes | 
| Sphererobot3MassesConf | Configuration object for the Sphererobot3Masses robot | 
| SphererobotConf | |
| StandartGenerationSizeStrategy | This class calculate the new generation size over the enhancement speed | 
| StandartMutationFactorStrategy | This strategy calculate the mutation factor by the variance of the gens in the giving set | 
| StatisticMeasure | Class used by StatisticTools | 
| StatisticTools | |
| Storeable | Interface for objects, that can be stored and restored to/from a file stream (binary) | 
| StraightLine | Abstract class (interface) for obstacles | 
| Substance | Physical substance definition, used for collision detection/treatment What we need is mu, slip and kp,kd parameter for the collision Definition of substance parameters: | 
| SumFitnessStrategy | Test implementation | 
| TableLine | |
| TaskedSimulation | |
| TaskedSimulationCreator | Defines a method to construct a TaskedSimulation | 
| Teachable | Interface for teachable controller | 
| TemplateValue | Template class for a IValue standard data type needs the data type and a methode for string converting as template argument | 
| TemplateValueAnalysation | This template class give you some methods to calculate some statistical values like average, min, max, upper quartil, lower quartil and many more | 
| TemplateValueAnalysation::TYPE_SAVE | Help structur for sorting the set | 
| TerrainGround | Class provides an terrain based on HeightFields | 
| TestFitnessStrategy | Test fitness strategy | 
| TextureDescr | Holds texture file and repeat information | 
| ThisSim | |
| TournamentSelectStrategy | This class makes a select by randomized comparison of two individual of the old generation | 
| Trackable | Abstract class (interface) for trackable objects (used for robots) | 
| TrackableMeasure | |
| TrackRobot | This class provides tracking possibilies of a robot | 
| Transform | Primitive for transforming a geom (primitive without body) in respect to a body (primitive with body) | 
| TruckMesh | Robot that looks like a Nimm 2 Bonbon :-) 4 wheels and a truck mesh like body | 
| TwoAxisJoint | |
| TwoAxisServo | General servo motor for 2 axis joints | 
| TwoAxisServoCentered | General servo motor for 2 axis joints with zero position centered | 
| TwoAxisServoVel | General servo motor to achieve position control for 2 axis joints that that internally controls the velocity of the motor (much more stable) with centered zero position | 
| UniversalJoint | |
| use_java_controller | Class for robot control with sine and cosine | 
| Uwo | UWO: Unknown Walk Object :-), looks like a plate with a lot of legs | 
| UwoConf | |
| ValueMutationStrategy | This mutation strategy clculate a mutation factor by using a mutation factor strategy an add this factor to the old gen | 
| Vertex | |
| VideoStream | |
| VierBeiner | Robot that should look like a dog | 
| VierBeinerConf | |
| Wheelie | This is a class, which models an annular robot | 
| WheelieConf | |
| WhiteNormalNoise | Generates white and normal distributed random numbers | 
| WhiteUniformNoise | Generates white (no averaging) uniformly distributed random number between "min" and "max" | 
| WiredController | The WiredController contains a controller and a wiring, which connects the controller with the robot | 
| WiringSequence | Implements a sequence of wirings | 
 1.4.7