 __DerivativeWiringConf | Configuration object for DerivativeWiring |
 _DerLinUniversConf | |
 _RandGen | Random generator with 48bit integer arithmentic |
 _UniversalControllerConf | |
 AbstractIAFControllerConf | |
 AbstractObstacle | Abstract class (interface) for obstacles |
  AbstractGround | |
   ComplexPlayground | Playground that uses an xfig file with polylines linetype 0 is normal wall linetype 1 is border thickness is used as well, thickness is multiplied with wallthickness |
   DummyGround | DummyGround which holds a DummyPrimitive (so getMainPrimitive() works) |
   OctaPlayground | |
   Playground | |
    ClosedPlayground | |
  Boxpile | Boxpile |
  DummyObstacle | DummyObstacle which holds a DummyPrimitive (so getMainPrimitive() works) |
  MeshGround | |
  MeshObstacle | |
  PassiveBox | (Passive) box as obstacle |
  PassiveCapsule | (Passive) capsule as obstacle |
  PassiveMesh | (Passive) mesh as obstacle |
  PassiveSphere | (Passive) sphere as obstacle |
  RandomObstacles | Passive random obstacles: with spawn and remove obstacles can be created and removed |
  Seesaw | Seesaw |
  TerrainGround | Class provides an terrain based on HeightFields |
 AbstractObstacle | |
  RaceGround | |
 AbstractTrackSection | Abstract class (interface) for obstacles |
  DegreeSegment | Class for degree segments |
  StraightLine | Abstract class (interface) for obstacles |
 AmosFourConf | |
 AmosIIConf | |
 AnisotropFrictionData | |
 Arm2SegmConf | |
 ArmConf | |
 SparseArray< I, D >::ArrayElement | |
 AshigaruConf | >ASHIGARU Configuration struct |
 SplitControl::Assoziation | |
 Attachment | Structure to hold attachment data for sensors and motors |
 BackCaller | Class prototype which provides functions to handle callbackable classes |
  BackCallerVector< _Tp, _Alloc > | Establishes for some methods the notifications for registered Callbackable instances (use addCallbackable(...)) |
  BackCallerVector< OdeAgent * > | |
  Configurable | Abstact class for configurable objects |
   AbstractController | Abstract class for robot controller (with some basic functionality) |
    AbstractControllerAdapter | Abstract adapter class (interface) for robot controller |
     AbstractMultiController | Abstract class (interface) for using multiple controller |
      OneActiveMultiPassiveController | Class (interface) for using multiple controller, the first one is the active one, which generates motor values |
     CrossMotorCoupling | This is an adapter for a teachable controller to implement a cross motor coupling, see dissertation of Georg Martius |
     DiscreteControllerAdapter | Adapter class for robot controller |
      Discretesizable | Abstact class for discretesizable controllers |
     MeasureAdapter | This is a passive controller adapter who is passive and can handle AbstractMeasures |
    AbstractIAFController | Abstract class (interface) for robot controller that uses an integrate and fire neuron model |
    BasicController | |
    Braitenberg | Simple braitenberg controler type 2 a and b (Aggressive,Cowardly) |
    ClassicReinforce | Class for robot controller using Q-learning algorithm |
    DerLinUnivers | Class for robot control with sine and cosine |
    FFNNController | Class for robot controller with a fixed neural network |
    HomeokinBase | Abstract class (interface) for robot controller that use are based on the homeokinetic prinziple |
     InvertMotorController | Extended HomeokinBase class (still abstract) for robot controller work in motorspace and use possibly many steps and adaptive learning rate |
      DerBigController | Class for robot controller is based on InvertMotorNStep |
      DerController | Class for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks) |
      DerInf | Class for robot controller is based on InvertMotorNStep |
      DerLinInvert | Class for robot controller is based on InvertMotorNStep |
      DerPseudoSensor | Class for robot controller is based on InvertMotorNStep |
      InvertMotorBigModel | Class for robot controller is based on InvertMotorNStep |
      InvertMotorNStep | Class for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks) |
      InvertMotorSpace | Class for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks) |
     SeMoX | This controller follows the prinziple of homeokinesis and implements the extensions described in the thesis of Georg Martius 2009, University Goettingen: Goal-Oriented Control of Self-organizing Behavior in Autonomous Robots |
    InvertController | Abstract class (interface) for robot controller that use direct matrix inversion and simple one layer networks |
     DInvert3ChannelController | Class for robot controller that use naglaa's direct matrix inversion for n channels (simple one layer networks) |
     Invert3ChannelController< NUMBER_CHANNELS, BUFFER_SIZE > | Class for robot controller that use naglaa's 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) |
    MotorBabbler | Class for robot control that does motor babbling, e.g |
    MultiReinforce | Class for robot controller using several feedforward networks (satelite) and one selforg controller |
    MutualInformationController | This is a controller who is passive at the moment, that means, he will not generate any motor values |
    OneControllerPerChannel | Class for using multiple controller, one for each joint |
    PiMax | This controller implements the predictive information maximization described in paper: to be published in PLoS ONE 2013 ArXiv preprint: http://arxiv.org/abs/1301.7473 |
    RemoteControlled | Controller that is explicity controlled remotely (no own intelligence) |
    ReplayController | Controller that replays a file |
    SineController | Class for robot control with sine, sawtooth and impuls |
     MultiSineController | |
    SoML | This controller implements the homeokinetic learning algorihm in sensor space with extended controller network |
    Sos | This controller implements the standard algorihm described the Chapter 5 (Homeokinesis) of book "The Playful Machine" |
    Sox | This controller implements the standard algorihm described the the Chapter 5 (Homeokinesis) with extensions of Chapter 15 of book "The Playful Machine" |
    SoxExpand | This controller implements the standard algorihm described the Chapter 3 (Homeokinesis) with body expansion via context sensors |
    SplitControl | Class for using multiple controller with one robot |
    SwitchController | Meta controller for switching control between different subcontrollers |
    UniversalController | Class for robot control with sine and cosine |
    use_java_controller | Class for robot control with sine and cosine |
   AbstractModel | Abstract class (interface) for a model that can be used by a controller |
    InvertableModel | Abstract class (interface) for invertable models |
     ESN | Class for robot control with sine, sawtooth and impuls |
     FeedForwardNN | Abstract class (interface) for feed forward rate based neural networks |
      MultiLayerFFNN | Multi layer neural network with configurable activation functions |
       Elman | Multilayer Neural Network with context neurons (after Elman and Jordan) Example of 2 hidden layer network with both, elman and jordan context units |
      OneLayerFFNN | Simple one layer neural network with configurable activation function |
     ModelWithMemoryAdapter | Multi layer neural network with configurable activation functions |
    NeuralGas | Neural gas class |
    SOM | Self-organised map class |
   AbstractRobot | Abstract class (interface) for robot in general |
    OdeRobot | Abstract class for ODE robots |
     AmosFour | |
     AmosII | |
     Arm | |
     Arm2Segm | |
     Ashigaru | Robot ASHIGARU :-) 3 legged robot which could be easily connected each other |
     DefaultCaterPillar | This is a class, which models a snake like robot |
      CaterPillar | This is a class, which models a snake like robot |
     Differential | Differential robot: two separated wheel on each side of the body Inherit from OdeRobot |
     Discus | A spherical robot with 3 internal masses, which can slide on their orthogonal axes |
     ForcedSphere | |
     Formel1 | Robot that looks like a Nimm 2 Bonbon :-) 4 wheels and a capsule like body |
     Hand | Artificial Hand |
     Hexapod | |
     HurlingSnake | Hurling snake is a string a beats |
     Kuka | Robot that emulates the Kuka lightweight robot arm, consisting of 5 arm segments, one endeffector upon and a small box representing the Tool-Center-Point (TCP) of the endeffector where different tools can be mounted |
     MuscledArm | |
     Nejihebi | Nejihebi Robot |
     Nimm2 | Robot that looks like a Nimm 2 Bonbon :-) 2 wheels and a cylinder like body |
      TwoWheeled | Robot is based on nimm2 with a camera installed |
     Nimm4 | Robot that looks like a Nimm 2 Bonbon :-) 4 wheels and a capsule like body Wheelorder: front left, front right, rear left, rear right |
      FourWheeled | Robot is based on nimm4 with 4 wheels and a capsule like body |
     ReplayRobot | |
     RobotChain | Chain of robots |
     Schlange | This is a class, which models a snake like robot |
      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 |
       PlattfussSchlange | This is a class, which models a snake like robot with flat ends and a big body in the middle |
      SchlangeVelocity | This is a class, which models a snake like robot |
     ShortCircuit | |
     Skeleton | Should look like a humanoid |
     SliderWheelie | This is a class, which models an annular robot |
     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 |
      Barrel2Masses | A barrel-like robot with 2 internal masses, which can slide on their orthogonal axes |
     TruckMesh | Robot that looks like a Nimm 2 Bonbon :-) 4 wheels and a truck mesh like body |
     Uwo | UWO: Unknown Walk Object :-), looks like a plate with a lot of legs |
     VierBeiner | Robot that should look like a dog |
    MyRobot | |
   ControllerNet | Multi layer neural network with configurable activation functions and propagation and projection methods suitable for homeokinesis controller |
   ForceBoostWiring | Implements one to one wiring that integrates the mismatch between motor commands (understood as target values) and sensor values and adds them to the controller output If more sensors than motors are used it uses just the first m sensors |
   Base | |
    Simulation | |
     TaskedSimulation | |
      ThisSim | Just create your own simulation, it's up to you |
     ThisSim | Just create your own simulation, it's up to you |
     ThisSim | Just create your own simulation, it's up to you |
   Gripper | A gripper can be attached to a primitive via its substance and implements gripping (a fixed joint) on collision with specified objects |
   OdeConfig | The class $name holds the configurable parameters of the simulation environment |
   Operator | |
    BoxRingOperator | An Operator for keeping robots within a sphere / box |
    LiftUpOperator | An Operator for lifting up a robot from time to time |
    LimitOrientationOperator | An Operator for limiting the orientation of the main primitive of a robot |
    PullToPointOperator | An Operator for pulling the main primitive of a robot towards a point |
   MotorNoiseWiring | Implements a one to one wiring that adds noise to the motor signals (the sensors will get no noise) |
   QLearning | Implements QLearning |
   WiredController | The WiredController contains a controller and a wiring, which connects the controller with the robot |
    Agent | The Agent contains a controller, a robot and a wiring, which connects robot and controller |
     OdeAgent | Specialised agent for ode robots |
  ConfigurableList | Establishes for some methods the notifications for registered Callbackable instances (use addCallbackable(...)) |
  VideoStream | |
 binary_function | |
  select_predicate | Predicate to select sensors |
   select_all | |
   select_firsthalf | |
   select_from_to | Select sensors in the range
(inclusively) |
 BoundingShape | Class for reading bounding shape description files (.bbox) and to create appropriate geoms |
 Bumper | |
 Callback | |
  MotionBlurDrawCallback | Class that enables motion blur for the scenegraph should be called in the main simulation loop |
 Callbackable | Interface class for a class which wants to be callback on a certain action |
  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 |
  HUDStatisticsManager | Manages all the stuff displaying statistics on the graphics window |
  Simulation | |
  StatisticTools | TODO: add possibility to pass description of a measure |
 Camera | A Robot Camera |
 CameraConf | |
 CameraHandle | Class which holds all data used by CameraManipulators |
 Camera::CameraImage | Structure to store the image data and information for display |
 CaterPillarConf | |
 ClassicReinforceConf | |
 Clock | A cross-platform clock class inspired by the Timer classes in Ogre (http://www.ogre3d.org) |
 ColorSchema | A store for colors with a set of aliases |
 COMMAND | |
 Nejihebi::Conf | Struct containing all the configuration options for the nejihebi robot |
 Dat | |
 DerBigControllerConf | |
 DerControllerConf | |
 DerInfConf | |
 DerLinInvertConf | |
 DerPseudoSensorConf | |
 DifferentialConf | |
 Discretisizer | Use this class to get discrete values |
 DiscusConf | Configuration object for the Discus robot |
 drand48_data | |
 DrawCallback | |
  Camera::PostDrawCallback | |
  VideoStream | |
 DynaAX12Conf | |
 GlobalDataBase::dynamic_agent_caster< Derived > | |
 ESNConf | |
 FootFrameConf | |
 ForcedSphereConf | |
 FourWheeledConf | |
 Gen | The Gen class |
 GenPrototype | The GenPrototype class |
 geomPairHash | |
 GlobalDataBase | |
  GlobalData | Data structure holding all essential global information |
 GripperConf | Configure object for Gripper |
 GUIEventHandler | |
  LpzHelpHandler | Event handler for adding on screen help to Viewers |
  RobotCameraManager | Manages camera sensors |
  Simulation | |
 HandConf | |
 HexagonBodyConf | |
 HexapodConf | |
 Inspectable::IConnection | |
 ieee754_double | |
 IException | |
 IFitnessStrategy | The interface for the fitness strategy of an individual |
  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 |
  InvertedFitnessStrategy | This strategy calculate the invert to a other strategy |
  SumFitnessStrategy | Test implementation |
  TemplateTaskedGaSimulationFitnessStrategy | Fitness strategy for this demonstration simulation |
  TestFitnessStrategy | Test fitness strategy |
 IGenerationSizeStrategy | This interface is to specify how big the next generation should be |
  FixGenerationSizeStrategy | This class implements the generation size strategy with a fix value which is over the constructor given |
  StandartGenerationSizeStrategy | This class calculate the new generation size over the enhancement speed |
 Inspectable::ILayer | |
 ImagePPM | |
 ImageProcessor | Base class for image processing units |
  StdImageProcessor | Standard image processor - convenience class for 1 to 1 image processing |
   AvgImgProc | Time average of image |
   BWImageProcessor | Black and white image |
   ColorFilterImgProc | Filters for a specific color (requires HSV, so use HSVImgProc before) |
   HSVImgProc | Converts the image to a HSV coded image |
   LineImgProc | Creates a lightsensitive sensorline |
 IMeasure | Class used by StatisticTools |
  AbstractMeasure | Class used by StatisticTools |
   ComplexMeasure | |
    TrackableMeasure | |
   StatisticMeasure | Class used by StatisticTools |
 IMutationFactorStrategy | This is a interface for a strategy, which is used by ValueMutationStrategy |
  FixMutationFactorStrategy | This strategy implementation return a fix value for the mutation factor |
  StandartMutationFactorStrategy | This strategy calculate the mutation factor by the variance of the gens in the giving set |
 IMutationStrategy | This interface gives the structur for the mutation of a gen |
  ValueMutationStrategy | This mutation strategy clculate a mutation factor by using a mutation factor strategy an add this factor to the old gen |
 Indices | |
 Individual | This class represent one individual of the complete gen |
 Inspectable | Interface for inspectable objects |
  AbstractController | Abstract class for robot controller (with some basic functionality) |
  AbstractModel | Abstract class (interface) for a model that can be used by a controller |
  AbstractWiring | Abstract wiring-object between controller and robot |
   CopyWiring | Implements a wiring where the motors are copied to several motors and the sensors are fusioned |
   DerivativeWiring | Implements a wiring (between controller and robot) which includes the first and second derivative of the original robot sensor values |
   FeedbackWiring | Implements essentionally a one to one wiring with feedback connections |
   ForceBoostWiring | Implements one to one wiring that integrates the mismatch between motor commands (understood as target values) and sensor values and adds them to the controller output If more sensors than motors are used it uses just the first m sensors |
   One2OneWiring | Implements one to one wiring of robot sensors to inputs of the controller and controller outputs to robot motors |
    MotorNoiseWiring | Implements a one to one wiring that adds noise to the motor signals (the sensors will get no noise) |
    SelectiveNoiseWiring | Implements a one to one wiring and allows to select the noise strength per sensor channel |
    SelectiveOne2OneWiring | Implements a selective one to one wiring of robot sensors to inputs of the controller and controller outputs to robot motors |
   WiringSequence | Implements a sequence of wirings |
  GenContext | The GenContext class |
  Generation | The Generation class |
  InspectableProxy | This class is a proxy for the inspectable class |
  IValue | This class is a interface for a value which is part of a gen |
   TemplateValue< Typ, toString > | Template class for a IValue standard data type needs the data type and a methode for string converting as template argument |
  AmosFour | |
  AmosII | |
  Ashigaru | Robot ASHIGARU :-) 3 legged robot which could be easily connected each other |
  Hexapod | |
  Nejihebi | Nejihebi Robot |
  Skeleton | Should look like a humanoid |
  StatisticTools | TODO: add possibility to pass description of a measure |
  WiredController | The WiredController contains a controller and a wiring, which connects the controller with the robot |
 InvertMotorBigModelConf | |
 InvertMotorNStepConf | |
 iparampair | |
 IRandomStrategy | This interface is to create a random IValue |
  DoubleRandomStrategy | This class create a IValue (TemplateValue with type double) and initialize it with an random double value |
 ISelectStrategy | This interface is for a select strategy of the generation class |
  EliteSelectStrategy | This class makes a elite select and bring only the best individual in the next generation |
  RandomSelectStrategy | This class makes a select by randomized comparison of one individual of the old generation with a random number |
  TournamentSelectStrategy | This class makes a select by randomized comparison of two individual of the old generation |
 Joint | |
  BallJoint | |
  FixedJoint | |
  OneAxisJoint | |
   HingeJoint | |
   SliderJoint | |
   TwoAxisJoint | |
    Hinge2Joint | |
    UniversalJoint | |
 JointLength | |
 AmosFour::Leg | |
 AmosII::Leg | |
 Ashigaru::Leg | Leg struct |
 Leg | |
 LiftUpOperatorConf | |
 Lyapunov | Class for calculating lyapunov exponents online, over several time horizons, from given Jacobi matrices |
 Operator::ManipDescr | Description of action (for visualization) |
 Mediator | |
 MediatorCollegue | |
 MediatorEvent | The default MediatorEvent holds no information, the implementation of the mediator should implement a derived version of the MediatorEvent |
 MultiReinforceConf | |
 MuscledArmConf | |
 NetUpdate | Updates for network |
 Nimm2Conf | |
 NoiseGenerator | Interface and basic class for noise generator |
  ColorUniformNoise | Generated colored noise. This is obtained by using time average of uniform distributed noise |
  NoNoise | Generates no noise |
  SineWhiteNoise | Sine wave noise. Produces a 90 degree phase shifted sine wave or white noise |
  WhiteNormalNoise | Generates white and normal distributed random numbers |
   ColorNormalNoise | Like ColorUniformNoise but averaging over normal distributed noise instead |
  WhiteUniformNoise | Generates white (no averaging) uniformly distributed random number between "min" and "max" |
 OdeHandle | Data structure for accessing the ODE |
 OpticalFlowConf | Configuration object for OpticalFlow |
 OSGCameraManipulator | |
  CameraManipulator | CameraManipulator is a MatrixManipulator which provides a flying camera updating of the camera position & orientation |
 OsgConfig | Data structure containing some configuration variables for OSG |
 OsgHandle | Data structure for accessing the OpenSceneGraph |
 OSGPrimitive | Interface class for graphic primitives like spheres, boxes, and meshes, which can be drawn by OSG |
  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 |
  OSGHeightField | Graphical HeightField |
  OSGLine | |
  OSGMesh | Graphical Mesh or arbitrary OSG model |
  OSGPlane | Graphical plane (represented as a large thin box, because OSG does not draw planes) |
  OSGSphere | Graphical sphere |
  OSGText | Text to be displayed on the hud |
 OsgScene | Data structure containing the scene notes (e.g |
 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 |
 Parametrizable | Using ParameterList = std::list<matrix::Matrix>; |
  PiMax | This controller implements the predictive information maximization described in paper: to be published in PLoS ONE 2013 ArXiv preprint: http://arxiv.org/abs/1301.7473 |
  SeMoX | This controller follows the prinziple of homeokinesis and implements the extensions described in the thesis of Georg Martius 2009, University Goettingen: Goal-Oriented Control of Self-organizing Behavior in Autonomous Robots |
  Sox | This controller implements the standard algorihm described the the Chapter 5 (Homeokinesis) with extensions of Chapter 15 of book "The Playful Machine" |
 parampair | |
 ModelWithMemoryAdapter::Pat | |
 PID | |
 PiMaxConf | Configuration object for PiMax controller. Use PiMax::getDefaultConf() |
 PlatformThreadObjects | |
 PlotOption | This class contains options for the use of an external plot utility like guilogger or neuronviz or just simply file output |
 PlotOptionEngine | |
 PolyLine | |
 Position | |
 PositionCameraSensorConf | |
  MotionCameraSensorConf | |
 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 |
 RandomObstaclesConf | |
 Reinforceable | Interface for reinforceable controller |
 RESTORE_GA_GENE | |
 RESTORE_GA_GENERATION | |
 RESTORE_GA_HEAD | |
 RESTORE_GA_INDIVIDUAL | |
 RESTORE_GA_TEMPLATE< Typ > | |
 RingBuffer< T > | |
 RobotChainConf | |
 Sat | Satelite network struct |
 SchlangeConf | |
 SeMoXConf | |
 SensorMotorInfo | Interface for objects, that can be stored and restored to/from a file stream (binary) |
 SensorMotorInfoAble | Abstract class for giving names to sensors and motors |
  Motor | Abstact base class for attachable motors |
   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) |
   ConstantMotor | Wrapper for Motor to have a constant set value (resulting in getMotorNumber()=0) |
   DummyMotor | |
   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 |
    SliderServoVel | Servo for sliders to achieve position control |
    Spring | |
   Speaker | This "motor" emulates a speaker or piezo element to produce sound |
   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 internally controls the velocity of the motor (much more stable) with centered zero position |
  Sensor | Abstract class for sensors that can be plugged into a robot |
   AngularMotor | Abstract angular motor class |
   AxisOrientationSensor | Class for sensing the axis orienation of a primitive (robot) |
   CameraSensor | Class to connect a Camera as a sensor to a robot |
    DirectCameraSensor | This CameraSensor implements a direct conversion from pixels to sensors |
    OpticalFlow | This CameraSensor calculates the optical flow at few points of the image based on a box matching technique |
    PositionCameraSensor | This CameraSensor calculates the position of the visible object(s) that is essentially the center of gravity of the image |
     MotionCameraSensor | This CameraSensor calculates the global optical flow of the camera image using the center of gravity method |
   DerivativeSensor | Class for measuring (time) derivatives of a given sensor |
   OneAxisServo | General servo motor to achieve position control |
   PhysicalSensor | Abstract class for sensors that have a physical representation |
    ContactSensor | Class for a contact sensor |
    RaySensor | Class for Ray-based sensors |
     IRSensor | Class for IR sensors |
    RaySensorBank | Class for a bank (collection) of ray sensors |
     RangeFinder | Class representing a range finder |
   RelativePositionSensor | Class for relative (or absolute) position sensing |
   SoundSensor | Sound sensor with possible direction and frequency detection and also distance dependence (Not implemented yet) This works, but is not very well tested and documented |
   SpeedSensor | Class for speed sensing of robots |
   TorqueSensor | Class for sensing the torque that are applied to the joint by a motor |
   TwoAxisServo | General servo motor for 2 axis joints |
 ServoParam | |
 SfitnessEliteStrategyStruct | Help structur to sort the individual by the fitness values |
 SimulationTask | |
 SimulationTaskHandle | Struct which holds all structural data for the simulations |
  ThisSimulationTaskHandle | |
 SimulationTaskSupervisor | |
 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 |
 SkeletonConf | |
 SliderWheelieConf | |
 Lyapunov::SlidingMatrix | Holds a matrix that is the result of a sliding window multiplication |
 SoMLConf | Configuration object for SoML controller |
 Sound | Object that represents a sound signal in the simulator |
 SoxConf | Configuration object for Sox controller. Use Sox::getDefaultConf() |
 SoxExpandConf | Configuration object for SoxExpand |
 SparseArray< I, D > | |
  SparseMatrix< I, D > | Sparse matrix which uses an HashTable first (fast implemented) version |
 SparseArray< long, int > | |
 SpecialParam | |
 Sphererobot3MassesConf | Configuration object for the Sphererobot3Masses robot |
 SphererobotConf | |
 StatLineProperties | |
 Storeable | Interface for objects, that can be stored and restored to/from a file stream (binary) |
  AbstractController | Abstract class for robot controller (with some basic functionality) |
  AbstractModel | Abstract class (interface) for a model that can be used by a controller |
  Layer | |
  OdeAgent | Specialised agent for ode robots |
  OdeRobot | Abstract class for ODE robots |
  Primitive | Interface class for primitives represented in the physical and graphical world |
   Box | Box primitive |
   Capsule | Capsule primitive |
   Cylinder | Cylinder primitive |
   DummyPrimitive | Dummy Primitive which returns 0 for geom and body |
   HeightField | Height field primitive |
   Mesh | Mesh primitive |
   Plane | Plane primitive |
   Ray | Ray primitive The actual visual representation can have different length than the ray object |
   Sphere | Sphere primitive |
   Transform | Primitive for transforming a geom (primitive without body) in respect to a body (primitive with body) |
    ImpTransform | |
  Matrix | Matrix type |
  QLearning | Implements QLearning |
 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: |
  DebugSubstance | |
 TaskedSimulationCreator | Defines a method to construct a TaskedSimulation |
  ThisSimCreator | Defines a method to construct a ThisSim |
 Teachable | Interface for teachable controller |
  CrossMotorCoupling | This is an adapter for a teachable controller to implement a cross motor coupling, see dissertation of Georg Martius |
  InvertMotorNStep | Class for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks) |
  PiMax | This controller implements the predictive information maximization described in paper: to be published in PLoS ONE 2013 ArXiv preprint: http://arxiv.org/abs/1301.7473 |
  SeMoX | This controller follows the prinziple of homeokinesis and implements the extensions described in the thesis of Georg Martius 2009, University Goettingen: Goal-Oriented Control of Self-organizing Behavior in Autonomous Robots |
  Sox | This controller implements the standard algorihm described the the Chapter 5 (Homeokinesis) with extensions of Chapter 15 of book "The Playful Machine" |
 TemplateValueAnalysation< type, zero, lower, higher, doubleDiv, doubleMul, add, sub, mul, div > | This template class give you some methods to calculate some statistical values like average, min, max, upper quartil, lower quartil and many more |
 TextureDescr | Holds texture file and repeat information |
 TmpObject | This is the base-class for objects that exist temporarily like some indicator of manipulation or a message text |
  TmpDisplayItem | Holding a temporary graphical item |
  TmpJoint | Holding a temporary joint |
  TmpPrimitive | Holding a temporary primitive |
 TraceDrawer | |
 Trackable | Abstract class (interface) for trackable objects (used for robots) |
  AbstractRobot | Abstract class (interface) for robot in general |
  TrackablePrimitive | |
 TrackRobot | This class provides tracking possibilies of a robot |
 TrackRobotConf | |
 Transform | |
  MoveEarthySkyWithEyePointTransform | |
 Ashigaru::Trunk | Trunk struct |
 TwoWheeledConf | |
 TemplateValueAnalysation< type, zero, lower, higher, doubleDiv, doubleMul, add, sub, mul, div >::TYPE_SAVE | Help structur for sorting the set |
 unary_function | |
  Configurable::matchId | Nice predicate function for finding by ID |
  ControllerGenerator | Generator for controller |
  Inspectable::matchName | Nice predicate function for finding a Layer with its vectorname |
  print_func< T > | |
  Sound::older_than | Nice predicate function for finding old sound signals |
  PlotOption::matchMode | Nice predicate function for finding by mode |
  join< T > | |
 UwoConf | |
 OpticalFlow::Vec2i | |
 Vec3 | |
  Pos | |
 Vec4 | |
  Axis | |
  Color | |
 vector | |
  BackCallerVector< _Tp, _Alloc > | Establishes for some methods the notifications for registered Callbackable instances (use addCallbackable(...)) |
  BackCallerVector< OdeAgent * > | |
  ConfigurableList | Establishes for some methods the notifications for registered Callbackable instances (use addCallbackable(...)) |
 Vertex | |
 VierBeinerConf | |
 Viewer | |
  LPZViewer | Viewer holds a single view on to a single scene that supports the rendering of offscreen RRT (render to texture) cameras at any time (without sync) |
 HUDStatisticsManager::WindowStatistic | Nested class WindowStatistic, which puts the measure and the graphics text together |