Class List

Here are the classes, structs, unions and interfaces with brief descriptions:
__DerivativeWiringConfConfiguration object for DerivativeWiring
_RandGenRandom generator with 48bit integer arithmentic
AbstractControllerAbstract class (interface) for robot controller
AbstractControllerAdapterAbstract adapter class (interface) for robot controller
AbstractGround
AbstractIAFControllerAbstract class (interface) for robot controller that uses an integrate and fire neuron model
AbstractIAFControllerConf
AbstractMeasureClass used by StatisticTools
AbstractModelAbstract class (interface) for a model that can be used by a controller
AbstractMultiControllerAbstract class (interface) for using multiple controller
AbstractObstacleAbstract class (interface) for obstacles
AbstractRobotAbstract class (interface) for robot in general
AbstractTrackSectionAbstract class (interface) for obstacles
AbstractWiringAbstract wiring-object between controller and robot
AddSensors2RobotAdapterRobot adapter to add sensors and also motors to robots without the need to modify the robot itself
AgentThe Agent contains a controller, a robot and a wiring, which connects robot and controller
AmosII
AmosIIConf
AngularMotorAbstract angular motor class
AngularMotor1AxisAngular motor for OneAxisJoints
AngularMotor2AxisAngular motor for TwoAxisJoints
AngularMotor3AxisEulerAngular motor for Ball Joints with Euler control
AngularMotorNAxisAngular motor for arbitrary Joints with custom axis (up to 3)
AnisotropFrictionData
Arm
Arm2Segm
Arm2SegmConf
ArmConf
ArrayElement
Assoziation
AvgImgProcTime average of image
Axis
AxisOrientationSensorClass for sensing the axis orienation of a primitive (robot)
BackCallerClass prototype which provides functions to handle callbackable classes
BackCallerVector< _Tp, _Alloc >Establishes for some methods the notifications for registered Callbackable instances (use addCallbackable(
BallJoint
Barrel2MassesA barrel-like robot with 2 internal masses, which can slide on their orthogonal axes
Barrel2Masses2ndA barrel-like robot with 2 internal masses, which can slide on their orthogonal axes
Base
BoundingShapeClass for reading bounding shape description files (.bbox) and to create appropriate geoms
BoxBox primitive
BoxpileBoxpile
BoxRingOperatorAn Operator for keeping robots within a sphere / box
BraitenbergSimple braitenberg controler type 2 a and b (Aggressive,Cowardly)
Bumper
BWImageProcessorBlack and white image
CallbackableInterface class for a class which wants to be callback on a certain action
CameraA Robot Camera
CameraConf
CameraHandleClass which holds all data used by CameraManipulators
CameraImageStructure to store the image data and information for display
CameraManipulatorCameraManipulator is a MatrixManipulator which provides a flying camera updating of the camera position & orientation
CameraManipulatorFollowCameraManipulatorFollow is a MatrixManipulator which provides Flying simulator-like updating of the camera position & orientation
CameraManipulatorRaceCameraManipulatorRace is a MatrixManipulator which provides Flying simulator-like updating of the camera position & orientation
CameraManipulatorTVCameraManipulatorTV is a MatrixManipulator which provides Flying simulator-like updating of the camera position & orientation
CameraSensorClass to connect a Camera as a sensor to a robot
CapsuleCapsule primitive
CaterPillarThis is a class, which models a snake like robot
CaterPillarConf
ClassicReinforceClass for robot controller using several feedforward networks (satelite) and one selforg controller
ClassicReinforceConf
ClockA cross-platform clock class inspired by the Timer classes in Ogre (http://www.ogre3d.org)
ClosedPlayground
Color
ColorFilterImgProcFilters for a specific color (requires HSV, so use HSVImgProc before)
ColorNormalNoiseLike ColorUniformNoise but averaging over normal distributed noise instead
ColorSchemaA store for colors with a set of aliases
ColorUniformNoiseGenerated colored noise. This is obtained by using time average of uniform distributed noise
COMMAND
ComplexMeasure
ComplexPlaygroundPlayground 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
ConfigurableAbstact class for configurable objects
ConfigurableListEstablishes for some methods the notifications for registered Callbackable instances (use addCallbackable(
ContactSensorClass for a contact sensor
ControllerGeneratorGenerator for controller
ControllerNetMulti layer neural network with configurable activation functions and propagation and projection methods suitable for homeokinesis controller
CopyWiringImplements a wiring where the motors are copied to several motors and the sensors are fusioned
CrossMotorCouplingThis is an adapter for a teachable controller to implement a cross motor coupling, see dissertation of Georg Martius
CylinderCylinder primitive
Dat
DebugSubstance
DefaultCaterPillarThis is a class, which models a snake like robot
DegreeSegmentClass for degree segments
DerivativeWiringImplements a wiring (between controller and robot) which includes the first and second derivative of the original robot sensor values
DirectCameraSensorThis CameraSensor implements a direct conversion from pixels to sensors
DiscreteControllerAdapterAdapter class for robot controller
DiscretesizableAbstact class for discretesizable controllers
DiscretisizerUse this class to get discrete values
DiscusA spherical robot with 3 internal masses, which can slide on their orthogonal axes
DiscusConfConfiguration object for the Discus robot
DoubleRandomStrategyThis class create a IValue (TemplateValue with type double) and initialize it with an random double value
drand48_data
DummyGroundDummyGround which holds a DummyPrimitive (so getMainPrimitive() works)
DummyMotor
DummyObstacleDummyObstacle which holds a DummyPrimitive (so getMainPrimitive() works)
DummyPrimitiveDummy Primitive which returns 0 for geom and body
dynamic_agent_caster< Derived >
EliteSelectStrategyThis class makes a elite select and bring only the best individual in the next generation
ElmanMultilayer Neural Network with context neurons (after Elman and Jordan) Example of 2 hidden layer network with both, elman and jordan context units
EuclidicDistanceFitnessStrategyThis fitness strategy calculate from all double gens (IValue<double>) the euclidic distance to zero
ExtreamTestFitnessStrategyAn example implementation and a extreme test for gen
FeedbackWiringImplements essentionally a one to one wiring with feedback connections
FeedForwardNNAbstract class (interface) for feed forward rate based neural networks
FFNNControllerClass for robot controller with a fixed neural network
FixedJoint
FixGenerationSizeStrategyThis class implements the generation size strategy with a fix value which is over the constructor given
FixMutationFactorStrategyThis strategy implementation return a fix value for the mutation factor
ForceBoostWiringImplements 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
ForcedSphere
ForcedSphereConf
Formel1Robot that looks like a Nimm 2 Bonbon :-) 4 wheels and a capsule like body
FourWheeledRobot is based on nimm4 with 4 wheels and a capsule like body
FourWheeledConf
GenThe Gen class
GenContextThe GenContext class
GenerationThe Generation class
GenPrototypeThe GenPrototype class
geomPairHash
GlobalDataData structure holding all essential global information
GlobalDataBase
GripperA gripper can be attached to a primitive via its substance and implements gripping (a fixed joint) on collision with specified objects
GripperConfConfigure object for Gripper
HandArtificial Hand
HandConf
HeightFieldHeight field primitive
Hexapod
HexapodConf
Hinge2Joint
HingeJoint
HomeokinBaseAbstract class (interface) for robot controller that use are based on the homeokinetic prinziple
HSVImgProcConverts the image to a HSV coded image
HUDStatisticsManagerManages all the stuff displaying statistics on the graphics window
HurlingSnakeHurling snake is a string a beats
IConnection
ieee754_double
IException
IFitnessStrategyThe interface for the fitness strategy of an individual
IGenerationSizeStrategyThis interface is to specify how big the next generation should be
ILayer
ImagePPM
ImageProcessorBase class for image processing units
IMeasureClass used by StatisticTools
IMutationFactorStrategyThis is a interface for a strategy, which is used by ValueMutationStrategy
IMutationStrategyThis interface gives the structur for the mutation of a gen
Indices
IndividualThis class represent one individual of the complete gen
InspectableInterface for inspectable objects
InspectableProxyThis class is a proxy for the inspectable class
InvertableModelAbstract class (interface) for invertable models
InvertControllerAbstract class (interface) for robot controller that use direct matrix inversion and simple one layer networks
InvertedFitnessStrategyThis strategy calculate the invert to a other strategy
InvertMotorBigModelClass for robot controller is based on InvertMotorNStep
InvertMotorBigModelConf
InvertMotorControllerExtended HomeokinBase class (still abstract) for robot controller work in motorspace and use possibly many steps and adaptive learning rate
InvertMotorNStepClass for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks)
InvertMotorNStepConf
InvertMotorSpaceClass for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks)
InvertNChannelControllerClass for robot controller that uses the georg's matrixlib for direct matrix inversion for n channels (simple one layer networks)
iparampair
IRandomStrategyThis interface is to create a random IValue
IRSensorClass for IR sensors
ISelectStrategyThis interface is for a select strategy of the generation class
IValueThis class is a interface for a value which is part of a gen
join< T >
Joint
Layer
Leg
Leg
LiftUpOperatorAn Operator for lifting up a robot from time to time
LiftUpOperatorConf
LimitOrientationOperatorAn Operator for limiting the orientation of the main primitive of a robot
LineImgProcCreates a lightsensitive sensorline
LpzHelpHandlerEvent handler for adding on screen help to Viewers
LPZViewerViewer 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)
LyapunovClass for calculating lyapunov exponents online, over several time horizons, from given Jacobi matrices
ManipDescrDescription of action (for visualization)
matchIdNice predicate function for finding by ID
matchModeNice predicate function for finding by mode
matchNameNice predicate function for finding a Layer with its vectorname
MatrixMatrix type
MeasureAdapterThis is a passive controller adapter who is passive and can handle AbstractMeasures
Mediator
MediatorCollegue
MediatorEventThe default MediatorEvent holds no information, the implementation of the mediator should implement a derived version of the MediatorEvent
MeshMesh primitive
MeshGround
MeshObstacle
ModelWithMemoryAdapterMulti layer neural network with configurable activation functions
MotionBlurDrawCallbackClass that enables motion blur for the scenegraph should be called in the main simulation loop
MotionBlurOperationClass that enables motion blur for the scenegraph should be called in the main simulation loop
MotionCameraSensorThis CameraSensor calculates the global optical flow of the camera image using the center of gravity method
MotionCameraSensorConf
MotorAbstact base class for attachable motors
MotorBabblerClass for robot control that does motor babbling, e.g
MotorNoiseWiringImplements a one to one wiring that adds noise to the motor signals (the sensors will get no noise)
MoveEarthySkyWithEyePointTransform
MultiLayerFFNNMulti layer neural network with configurable activation functions
MuscledArm
MuscledArmConf
MutualInformationControllerThis is a controller who is passive at the moment, that means, he will not generate any motor values
MyRobot
NetUpdateUpdates for network
Nimm2Robot that looks like a Nimm 2 Bonbon :-) 2 wheels and a cylinder like body
Nimm2Conf
Nimm4Robot that looks like a Nimm 2 Bonbon :-) 4 wheels and a capsule like body Wheelorder: front left, front right, rear left, rear right
NoiseGeneratorInterface and basic class for noise generator
NoNoiseGenerates no noise
OctaPlayground
OdeAgentSpecialised agent for ode robots
OdeConfigThe class $name holds the configurable parameters of the simulation environment
OdeHandleData structure for accessing the ODE
OdeRobotAbstract class for ODE robots
older_thanNice predicate function for finding old sound signals
One2OneWiringImplements one to one wiring of robot sensors to inputs of the controller and controller outputs to robot motors
OneActiveMultiPassiveControllerClass (interface) for using multiple controller, the first one is the active one, which generates motor values
OneAxisJoint
OneAxisServoGeneral servo motor to achieve position control
OneAxisServoCenteredGeneral servo motor to achieve position control with zero position centered
OneAxisServoVelGeneral servo motor to achieve position control
OneControllerPerChannelClass for using multiple controller, one for each joint
OneLayerFFNNSimple one layer neural network with configurable activation function
Operator
OpticalFlowThis CameraSensor calculates the optical flow at few points of the image based on a box matching technique
OpticalFlowConfConfiguration object for OpticalFlow
OSGBoxGraphical box
OSGBoxTexGraphical box with Textures
OSGCapsuleGraphical capsule (a cylinder with round ends)
OsgConfigData structure containing some configuration variables for OSG
OSGCylinderGraphical cylinder
OSGDummyA dummy graphical object, which has no representation in the graphical world
OsgHandleData structure for accessing the OpenSceneGraph
OSGHeightFieldGraphical HeightField
OSGMainLoop
OSGMeshGraphical Mesh or arbitrary OSG model
OSGPlaneGraphical plane (represented as a large thin box, because OSG does not draw planes)
OSGPrimitiveInterface class for graphic primitives like spheres, boxes, and meshes, which can be drawn by OSG
OsgSceneData structure containing the scene notes (e.g
OSGSphereGraphical sphere
OSGTextText to be displayed on the hud
ParallelTaskA base class for parallel task classes which are defined by a set of macros
ParallelTaskManagerA 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
Pat
PID
PlanePlane primitive
PlatformThreadObjects
PlattfussSchlangeThis is a class, which models a snake like robot with flat ends and a big body in the middle
Playground
PlotOptionThis class contains options for the use of an external plot utility like guilogger or neuronviz or just simply file output
PlotOptionEngine
PolyLine
Pos
Position
PositionCameraSensorThis CameraSensor calculates the position of the visible object(s) that is essentially the center of gravity of the image
PositionCameraSensorConf
PostDrawCallback
PrimitiveInterface class for primitives represented in the physical and graphical world
PrimitiveComponentComponent consisting of one Primitive
print_func< T >
ProfileBlockA simple data structure representing a single timed block of code
ProfilerA singleton class that manages timing for a set of profiling blocks
PullToPointOperatorAn Operator for pulling the main primitive of a robot towards a point
QLearningImplements QLearning
RaceGround
RandomObstaclesPassive random obstacles: with spawn and remove obstacles can be created and removed
RandomObstaclesConf
RandomSelectStrategyThis class makes a select by randomized comparison of one individual of the old generation with a random number
RayRay primitive The actual visual representation can have different length than the ray object
RaySensorAbstract class for Ray-based sensors
RaySensorBankClass for a bank (collection) of ray sensors
RelativePositionSensorClass for relative position sensing
ReplayControllerController that replays a file
ReplayRobot
RESTORE_GA_GENE
RESTORE_GA_GENERATION
RESTORE_GA_HEAD
RESTORE_GA_INDIVIDUAL
RESTORE_GA_TEMPLATE< Typ >
RobotCameraManagerManages camera sensors
RobotChainChain of robots
RobotChainConf
SchlangeThis is a class, which models a snake like robot
SchlangeConf
SchlangeForceThis is a class, which models a snake like robot
SchlangeServoThis is a class, which models a snake like robot
SchlangeServo2This is a class, which models a snake like robot
SchlangeVelocityThis is a class, which models a snake like robot
SeesawSeesaw
select_all
select_firsthalf
select_from_toSelect sensors in the range

\[ [from, to] \]

(inclusively)

select_predicatePredicate to select sensors
SelectiveNoiseWiringImplements a one to one wiring and allows to select the noise strength per sensor channel
SelectiveOne2OneWiringImplements a selective one to one wiring of robot sensors to inputs of the controller and controller outputs to robot motors
SeMoXThis 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
SeMoXConf
SensorAbstract class for sensors that can be plugged into a robot
SfitnessEliteStrategyStructHelp structur to sort the individual by the fitness values
ShortCircuit
Simulation
SimulationTask
SimulationTaskHandleStruct which holds all structural data for the simulations
SimulationTaskSupervisor
SineControllerClass for robot control with sine, sawtooth and impuls
SineWhiteNoiseSine wave noise. Produces a 90 degree phase shifted sine wave or white noise
SingletonGenAlgAPIThis is a facade for the gen
SingletonGenEngineThis is the engine of the gen
SingletonGenFactoryThis is the factory for the class Gen
SingletonIndividualFactoryThis is a factory for the individual class
SkeletonShould look like a humanoid
SkeletonConf
SliderJoint
SliderWheelieThis is a class, which models an annular robot
SliderWheelieConf
SlidingMatrixHolds a matrix that is the result of a sliding window multiplication
SOMSelf-organised map class
SoMLThis controller implements the homeokinetic learning algorihm in sensor space with extended controller network
SoMLConfConfiguration object for SoML controller
SosThis controller implements the standard algorihm described the Chapter 5 (Homeokinesis) of book "The Playful Machine"
SoundObject that represents a sound signal in the simulator
SoundSensorSound sensor with possible direction and frequency detection and also distance dependence (Not implemented yet) This works, but is not very well tested and documented
SoxThis controller implements the standard algorihm described the the Chapter 5 (Homeokinesis) with extensions of Chapter 15 of book "The Playful Machine"
SoxConfConfiguration object for Sox controller. Use Sox::getDefaultConf()
SoxExpandThis controller implements the standard algorihm described the Chapter 3 (Homeokinesis) with body expansion via context sensors
SoxExpandConfConfiguration object for SoxExpand
SparseArray< I, D >
SparseMatrix< I, D >Sparse matrix which uses an HashTable first (fast implemented) version
SpeakerThis "motor" emulates a speaker or piezo element to produce sound
SpeedSensorClass for speed sensing of robots
SphereSphere primitive
SphererobotThis is a class, which models a snake like robot
Sphererobot3MassesA spherical robot with 3 internal masses, which can slide on their orthogonal axes
Sphererobot3MassesConfConfiguration object for the Sphererobot3Masses robot
SphererobotConf
SplitControlClass for using multiple controller with one robot
Spring
StandartGenerationSizeStrategyThis class calculate the new generation size over the enhancement speed
StandartMutationFactorStrategyThis strategy calculate the mutation factor by the variance of the gens in the giving set
StatisticMeasureClass used by StatisticTools
StatisticToolsTODO: add possibility to pass description of a measure
StdImageProcessorStandard image processor - convenience class for 1 to 1 image processing
StoreableInterface for objects, that can be stored and restored to/from a file stream (binary)
StraightLineAbstract class (interface) for obstacles
SubstancePhysical substance definition, used for collision detection/treatment What we need is mu, slip and kp,kd parameter for the collision Definition of substance parameters:
SumFitnessStrategyTest implementation
TaskedSimulation
TaskedSimulationCreatorDefines a method to construct a TaskedSimulation
TeachableInterface for teachable controller
TemplateTaskedGaSimulationFitnessStrategyFitness strategy for this demonstration simulation
TemplateValue< Typ, toString >Template class for a IValue standard data type needs the data type and a methode for string converting as template argument
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
TerrainGroundClass provides an terrain based on HeightFields
TestFitnessStrategyTest fitness strategy
TextureDescrHolds texture file and repeat information
ThisSimJust create your own simulation, it's up to you
ThisSimCreatorDefines a method to construct a ThisSim
ThisSimulationTaskHandle
TmpDisplayItemHolding a temporary graphical item
TmpJointHolding a temporary joint
TmpObjectThis is the base-class for objects that exist temporarily like some indicator of manipulation are a message
TmpPrimitiveHolding a temporary primitive
TorqueSensorClass for sensing the torque that are applied the joint by a motor
TournamentSelectStrategyThis class makes a select by randomized comparison of two individual of the old generation
TraceDrawer
TrackableAbstract class (interface) for trackable objects (used for robots)
TrackableMeasure
TrackablePrimitive
TrackRobotThis class provides tracking possibilies of a robot
TrackRobotConf
TransformPrimitive for transforming a geom (primitive without body) in respect to a body (primitive with body)
TruckMeshRobot that looks like a Nimm 2 Bonbon :-) 4 wheels and a truck mesh like body
TwoAxisJoint
TwoAxisServoGeneral servo motor for 2 axis joints
TwoAxisServoCenteredGeneral servo motor for 2 axis joints with zero position centered
TwoAxisServoVelGeneral 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
TwoWheeledRobot is based on nimm2 with a camera installed
TwoWheeledConf
TYPE_SAVEHelp structur for sorting the set
UniversalJoint
use_java_controllerClass for robot control with sine and cosine
UwoUWO: Unknown Walk Object :-), looks like a plate with a lot of legs
UwoConf
ValueMutationStrategyThis mutation strategy clculate a mutation factor by using a mutation factor strategy an add this factor to the old gen
Vec2i
vector
Vertex
VideoStream
VierBeinerRobot that should look like a dog
VierBeinerConf
WhiteNormalNoiseGenerates white and normal distributed random numbers
WhiteUniformNoiseGenerates white (no averaging) uniformly distributed random number between "min" and "max"
WindowStatisticNested class WindowStatistic, which puts the measure and the graphics text together
WiredControllerThe WiredController contains a controller and a wiring, which connects the controller with the robot
WiringSequenceImplements a sequence of wirings
Generated on Thu Jun 28 14:48:05 2012 for Robot Simulator of the Robotics Group for Self-Organization of Control by  doxygen 1.6.3