Robot Simulator of the Robotics Group for Self-Organization of Control Class List

Here are the classes, structs, unions and interfaces with brief descriptions:
__DerivativeWiringConfConfiguration Object for DerivativeWiring
_ComponentConf
_RandGen
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
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)
Arm
Arm2Segm
Arm2SegmConf
ArmConf
AtomComponentAtomComponent
AtomComponent::connectionAddition
AtomConf
Axis
AxisOrientationSensorClass for sensing the axis orienation of a primitive (robot)
BackCallerClass prototype which provides functions to handle callbackable classes
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
BasicControllerClass for robot controller is based on InvertMotorNStep
BasicControllerConf
BoundingShapeClass for reading bounding shape description files (.bbox) and to create appropriate geoms
BoxBox primitive
Bumper
CallbackableInterface class for a class which wants to be callback on a certain action
CameraHandleClass which holds all data used by CameraManipulators
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
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
ColorNormalNoiseLike ColorUniformNoise but averaging over normal distributed noise instead
ColorUniformNoiseGenerated colored noise. This is obtained by using time average of uniform distributed noise
COMMAND
ComplexMeasure
ComplexPlaygroundPlayground 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
ComponentThis is the abstract base class of the component system
Component::componentConnectionThis is the structure of one connection between two components
ConfigurableAbstact class for configurable objects
Configurable::matchIdNice predicate function for finding by ID
CylinderCylinder primitive
DefaultCaterPillarThis is a class, which models a snake like robot
DefaultWheelieThis 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
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
DummyMotor
DummyPrimitiveDummy Primitive which returns 0 for geom and body
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
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
HandArtificial Hand
HandConf
HeightFieldHeight field primitive
Hinge2Joint
HingeJoint
HomeokinBaseAbstract class (interface) for robot controller that use are based on the homeokinetic prinziple
HUDStatisticsManagerManages all the stuff displaying statistics on the graphics window
HUDStatisticsManager::WindowStatisticNested class WindowStatistic, which puts the measure and the graphics text together
HurlingSnakeHurling snake is a string a beats
ieee754_double
IException
IFitnessStrategyThe interface for the fitness strategy of an individual
IGenerationSizeStrategyThis interface is to specify how big the next generation should be
ImagePPM
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
Inspectable::IConnection
Inspectable::ILayer
Inspectable::matchNameNice predicate function for finding a Layer with its vectorname
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
Joint
Layer
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
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
MotorAbstact base class for attachable motors
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
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
One2OneWiringImplements one to one wireing 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 that that internally controls the velocity of the motor (much more stable) with centered zero position
OneLayerFFNNSimple one layer neural network with configurable activation function
OSGBoxGraphical box
OSGBoxTexGraphical box with Textures
OSGCapsuleGraphical capsule (a cylinder with round ends)
OSGCylinderGraphical cylinder
OSGDummyA dummy graphical object, which has no representation in the graphical world
OsgHandleData structure for accessing the ODE
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
OSGSphereGraphical sphere
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
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
PlotOption::matchModeNice predicate function for finding by mode
PlotOptionEngine
PolyLine
Pos
Position
PrimitiveInterface class for primitives represented in the physical and graphical world
PrimitiveComponentComponent consisting of one Primitive
ProfileBlockA simple data structure representing a single timed block of code
ProfilerA singleton class that manages timing for a set of profiling blocks
QLearningImplements QLearning
RaceGround
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
repSlider
RESTORE_GA_GENE
RESTORE_GA_GENERATION
RESTORE_GA_HEAD
RESTORE_GA_INDIVIDUAL
RESTORE_GA_TEMPLATE
RobotComponentThis is a special class of the component system
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
select_all
select_firsthalf
select_from_toSelect sensors in the range

\[ [from, to] \]

(inclusively)

select_predicatePredicate to select sensors
SelectiveOne2OneWiringImplements a selective one to one wireing of robot sensors to inputs of the controller and controller outputs to robot motors
SensorAbstract class for sensors that have no specific position at the robots skeleton
SfitnessEliteStrategyStructHelp structur to sort the individual by the fitness values
ShadowDrawCallback
ShortCircuit
SimpleComponentA simple component is a special form of component
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
SliderJoint
SliderWheelieThis is a class, which models an annular robot
SliderWheelieConf
SOMSelf-organised map class
SoundObject that represents a sound signal in the simulator
Sound::older_thanNice predicate function for finding old sound signals
SoundSensorSound sensor with possible direction and frequency detection and also distance dependence
SparseArray
SparseArray::ArrayElement
SparseMatrixSparse matrix which uses an HashTable first (fast implemented) version
Speaker
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
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
StatisticTools
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
TableLine
TaskedSimulation
TaskedSimulationCreatorDefines a method to construct a TaskedSimulation
TeachableInterface for teachable controller
TemplateValueTemplate class for a IValue standard data type needs the data type and a methode for string converting as template argument
TemplateValueAnalysationThis template class give you some methods to calculate some statistical values like average, min, max, upper quartil, lower quartil and many more
TemplateValueAnalysation::TYPE_SAVEHelp structur for sorting the set
TerrainGroundClass provides an terrain based on HeightFields
TestFitnessStrategyTest fitness strategy
TextureDescrHolds texture file and repeat information
ThisSim
TournamentSelectStrategyThis class makes a select by randomized comparison of two individual of the old generation
TrackableAbstract class (interface) for trackable objects (used for robots)
TrackableMeasure
TrackRobotThis class provides tracking possibilies of a robot
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 that internally controls the velocity of the motor (much more stable) with centered zero position
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
Vertex
VideoStream
VierBeinerRobot that should look like a dog
VierBeinerConf
WheelieThis is a class, which models an annular robot
WheelieConf
WhiteNormalNoiseGenerates white and normal distributed random numbers
WhiteUniformNoiseGenerates white (no averaging) uniformly distributed random number between "min" and "max"
WiredControllerThe WiredController contains a controller and a wiring, which connects the controller with the robot
WiringSequenceImplements a sequence of wirings

Generated on Fri Oct 30 16:29:02 2009 for Robot Simulator of the Robotics Group for Self-Organization of Control by  doxygen 1.4.7