| Action | A class describing a single action |
| Actionfield | A class for selecting an action using potentialfields |
| AmongFormation | A class representing a formation among several objects |
| AngleSymbols | The Xabsl2 symbols that are defined in "angle-symbols.xml" |
| AStarSearch< N, P, U > | An abstract implementation of the A* search algorithm |
| AsymptoticFunction | A class representing an asymptotic function in a potential field f(x) = a/x +b |
| AutoShutter | A AutoShutter |
| BallLocator | The Base class for ball locators |
| BallLocatorInterfaces | The interfaces of the BallLocator module |
| BallLocatorSelector | A module selector for ball locators |
| BallModel | Contains the modeled knowledge about the ball |
| BallPercept | Contains a percept for a ball |
| BallState | Qualitative proposition for the ball |
| BallSymbols | The Xabsl2 symbols that are defined in "ball-symbols.xml" |
| BarCodeReader | A BarCode Reader |
| BasicBehaviorDoNothing | A Basic Behavior for doing nothing |
| BasicBehaviorPlayDead | A Basic Behavior for playing dead robot |
| BasicBehaviorShutdown | A Basic Behavior for shutdown |
| BasicBehaviorSpecialAction | A Basic Behavior for special actions like kicks |
| BasicBehaviorStand | A Basic Behavior for standing around |
| BasicBehaviorWalk | A Basic Behavior for walking |
| BB2004Calibrator | The class calibrates the correction values for the camera matrix |
| BB2004InvKinWalkingEngine | This class implements a walking engine that optimizes its parameters using evolutionary algorithms |
| BB2004InvKinWalkingEngine::FootPositions | The class represents a pair of positions of the back feet |
| BBIndividual | The class is the abstract base class for indiviuals |
| BBInvKinIndividual | The class represents an individual for a set of walking parameters |
| BBPopulation< T > | The template class represents a population of indiviuals |
| BehaviorControl | The Base class for behavior controls |
| BehaviorControlInterfaces | The interfaces of the BehaviorControl module |
| BehaviorControlSelector | BehaviorControl selection module |
| BehaviorTeamMessage | Represents a message that is exchanged between the behaviors of different robots |
| BehaviorTeamMessage::WalkR | |
| BestFitFormation | A class representing a formation selection the "best fitting" formation out of a set of SingleFormations |
| BetweenFormation | A class representing a formation between two other objects |
| BitePoint | A class that contains a certain bitePoint at the open challenge bridge |
| BodyPercept | The class represents the robots body percept |
| BodyPosture | The class represents the robots body percept |
| Boundary< T > | The template class represents rectangular boundaries |
| BoxSpecialist | This class implements the landmark and goal detection algorithms of the RIP |
| BoxSpecialist::Rectangle | Struct that represents a rectangle |
| BoxSpecialist::SegmentInfo | This struct holds information about a segment in the image |
| BresenhamLineScan | |
| CalibrationIndividual | The class represents an individual for a set of walking parameters |
| CalibrationRequest | A request for calibration |
| CalibrationSymbols | The Xabsl2 symbols that are defined in "calibration-symbols.xml" |
| CameraInfo | Matrix describing transformation from neck joint to camera |
| CameraMatrix | Matrix describing transformation from neck joint to camera |
| CameraParameters | Adjust parameters for built-in camera of Sony robot |
| ChallengeSectorData | |
| ChallengeSpecialVision | |
| ChallengeSymbols | The Xabsl2 symbols that are defined in "challenge-symbols.xml" |
| CheckerboardDetector | A solution of the ImageProcessor module that looks for vertical checkerboards (a row of black and white ~10x10cm tiles with a white boarder and a middle mark in eye height that allows precise location of the robot relative to the checkerboard from a single image |
| ChooserRaterInterfaces | The interface class for communication between TacticChooser and OptionRater |
| Circle | A class representing a circle |
| CircleCalculation | |
| CircleCalculation::BallPoint | The struct represents a ball point |
| Cognition | A Process for cognition related modules in the HU1 process layout |
| CollectedBeliefs | This class contains the PlayerPoses of all detected robots |
| CollisionDetector | The base class for collision detectors |
| CollisionDetectorInterfaces | The interfaces of the CollisionDetector module |
| CollisionDetectorSelector | CollisionDetector selection module |
| CollisionPercept | Contains detected collisions for each joint |
| ColorClasses | Static class for color class functions |
| ColorClassImage | Represents a color segmented image |
| ColorCorrector | The class represents a table for color correction |
| coloredLinePair2 | |
| ColorSpaceUsageCounter | Contains a ColorSpaceUsageCounter which can count the frequency for every 16 * 16 * 16 cube in the 255 * 255 * 255 YUV color space |
| ColorTable | Base class of ColorTable64 and ColorTableTSL |
| ColorTable32K | Contains a ColorTable32K which can decode the color for every 16 * 4 * 4 cube in the 255 * 255 * 255 YUV color space |
| ColorTable32KMod | This class is a wrapper used by ColorTableModSelector to load and instantiate a colormap of type ColorTable32K |
| ColorTable64 | Contains a ColorTable64 which can decode the color for every 4 * 4 * 4 cube in the 255 * 255 * 255 YUV color space |
| ColorTable64Mod | This class is a wrapper used by ColorTableModSelector to load and instantiate a colormap of type ColorTable64 |
| ColorTableCuboids | |
| ColorTableMod | Base class of color table modules, used to load and switch color tables at runtime |
| ColorTableModInterfaces | The interface used by ColorTableMod ("Monsieur De Lapalisse" :) |
| ColorTableModSelector | A selector for color table modules |
| ColorTableReferenceColor | |
| ColorTableTSL | Contains a ColorTableTSL which can decode the color for every 8 * 4 * 4 cube in the 255 * 255 * 255 YUV color space |
| ColorTableTSLMod | This class is a wrapper used by ColorTableModSelector to load and instantiate a colormap of type ColorTableTSL |
| CommonBasicBehaviors | Creates and registers simple basic behaviors |
| CommunicatedBallPosition | The position of the ball estimated from own observations and from observation of other players |
| ConditionalBoundary | The class represents a rectangular landmark boundary |
| DDPHandler | This class handles the Dog-Discovery-Protocol DDP |
| DDPListEntry | Used to store the information of one discovered robot |
| DDPPackage | This class represents the data package which is send over the network |
| Debug | A process for collection and distribution of debug messages |
| DebugKey | Represents a request for debug output |
| DebugKeyTable | Contains a table of debug keys and all methods for using debug keys |
| DebugMotionControl | A MotionControl module for debugging purposes |
| DebugSender | This class implements a sender for MessageQueues |
| DefaultOptionRating | A simple implementation of the DefaultOptionRating class |
| DefaultRobotStateDetector | A solution of the RobotStateDetector module |
| DefaultSpecialVision | The default SpecialVision module |
| DefaultTacticChooser | A simple implementation of the DefaultTacticChooser class |
| DefGlobalAnalyser | A simple implementation of the DefGlobalAnalyser class |
| DistanceToBorderEstimator | The class implements a lines-based Monte Carlo self-localization |
| Drawings | This class includes all enumeration types and methods that are necessary to transmit messages for debug drawings |
| edge | |
| EdgesPercept | The class represents a percepted edge on the field |
| EdgesPercept::Edge | |
| ERS7EvolveWalkingParameters | Parameters for InvKinWalkingEngine to evolve better walking gates |
| EvolutionSymbols | The Xabsl2 symbols that are defined in "evolution-symbols.xml" |
| extLinePair | |
| FastSUSANNoiseReduction | This class represents a non-linear image noise-reduction filter |
| Field | The class represents the field area |
| Field::Table | This is a collection of line- or boundary segments with start-Pose2D and length |
| FieldDimensions | Static class containing some useful functions regarding field dimensions |
| figure | Definition of an edge and a linePair : very convenient for mixing both in a list |
| File | This class provides basic file input/output capabilies |
| file | This is a utility class for image processing |
| Flag | The class represents a flag |
| FormationObject | A class representing a formation in a potential field |
| ForwardTurningParcour | Contains a special walking parcour |
| FourierCoefficient | This class contains a set of fourier coefficients as well as methods transform them from and to a period of function values |
| FutureWorldModelGenerator | A class for computing a world model after excuting a specific action |
| GameControlData | Encapsulates the RoboCupGameControlData struct for the GT2003 project |
| GaussBell | This class contains attributes and methods which are necessary for the fusion of Gauss-Bells |
| GenericDebugData | |
| Geometry | The class Geometry defines representations for geometric objects and Methods for calculations with such object |
| Geometry::Circle | Defines a circle by its center and its radius |
| Geometry::CorrectedCoords | A radial distortion correction look-up table element |
| Geometry::Line | Defines a line by two vectors |
| Geometry::PixeledLine | |
| Geometry::SetOfPoints< V, maxNumberOfPoints > | |
| GetupEngine | A generic class for getup engine modules |
| GetupEngineInterfaces | Interfaces of the GetupEngine module |
| GetupEngineSelector | A module selector for GetupEngine modules |
| GlobalAnalyser | The Base class for global analysis |
| GlobalGameControlData | Specifies the game state for two teams of four robots |
| Goal | The class represents a goal |
| GoalRecognizer | The goal recognizer recognizes the goals in the image |
| GoalRecognizer::ColoredPartsCheck | |
| GT2003MotionNetSpecialActions | This module executes special actions by using the GT2003 motion net compiler |
| GT2003MotionNetSpecialActions::OdometryEntry | Odometry table entry Contains type of odometry and odometry pose |
| GT2004BallLocator | A BallLocator using GT2004 filtering |
| GT2004BallLocatorDebugData | Contains action IDs for GT2004BallLocator debugging |
| GT2004BallSpecialist | The BallSpecialist finds a single ball in an image |
| GT2004BallSpecialist::BallPoint | The class represents a ball point |
| GT2004BallSpecialist::BallPointList | |
| GT2004BasicBehaviorDirectedScanForLandmarks | The basic behavior "look-at-close-landmarks" |
| GT2004BasicBehaviorDogAsJoystick | A Basic Behavior for going to a point on the field and avoiding obstacles on the way there |
| GT2004BasicBehaviorEvolveOmniParameters | A BasicBehavior for walking forward or backward following a certain parcour as well as changing walking parameters according to the fitness measured in the last parcour walk This Basic Behavior needs a walking engine that does not switch parameters according to the MotionRequest (like InvKin:GT2003 and GT2004), but a non-switching one (like InvKin:FF) |
| GT2004BasicBehaviorGoaliePosition | A goalie positioning approach from Benjamin |
| GT2004BasicBehaviorGoaliePositionReturn | A Basic Behavior for positioning the goalie inside the own goal |
| GT2004BasicBehaviorGoForwardToPoint | A Basic Behavior for going to a point on the field facing forward |
| GT2004BasicBehaviorGoToBall | A Basic Behavior for going to the ball |
| GT2004BasicBehaviorGoToBallWithoutTurning | A Basic Behavior for clearing the ball |
| GT2004BasicBehaviorGoToPoint | A Basic Behavior for going to a point on the field |
| GT2004BasicBehaviorGoToPointAndAvoidObstacles | A Basic Behavior for going to a point on the field and avoiding obstacles on the way there |
| GT2004BasicBehaviorMeasureGT2004Parameters | A BasicBehavior for measuring and calibrating an the current GT2004Parameters |
| GT2004BasicBehaviorMeasureGT2004ParametersBlind | A BasicBehavior for measuring and calibrating an the current GT2004Parameters while being partially blind (while turning) |
| GT2004BasicBehaviorMoveTheBridge | A Basic Behavior for going to a point on the field and avoiding obstacles on the way there |
| GT2004BasicBehaviorNextGT2004ParametersToBeMeasured | A BasicBehavior for generating the next GT2004Parameters to be measured exactly |
| GT2004BasicBehaviorSendCurrentGT2004ParametersAndChooseNext | A BasicBehavior for sending the current GT2004Parameters via PackageCognitionMotion to the walking engine and choose the next Parameters to be optimized |
| GT2004BasicBehaviorTurnAroundPoint | A Basic Behavior for going turning around a point on the field |
| GT2004BeaconDetector | A class for detecting beacons in images |
| GT2004BehaviorControl | A Behavior based on the Xabsl2Engine that is used by GermanTeam for the RoboCup 2004 |
| GT2004CollisionDetector | The default CollisionDetector in the GT2004 project |
| GT2004ConfigurationSymbols | The Xabsl2 symbols that are defined in "configuration-symbols.xml" |
| GT2004DTTSymbols | The Xabsl2 symbols that are defined in "dtt-symbols.xml" |
| GT2004EdgeSpecialist | The EdgeSpecialist finds a line- and border-edges in an image |
| GT2004EdgeSpecialist::EdgePoint | |
| GT2004EvolutionBasicBehaviors | Creates and registers simple basic behaviors |
| GT2004FlagSpecialist | As part of the GridImageProcessor the GT2004FlagSpecialist searches for flag landmarks starting at a point in an Image determined before |
| GT2004GetupEngine | The GT2004 getup engine |
| GT2004GoalRecognizer | The goal recognizer recognizes the goals in the image |
| GT2004GoalRecognizer::ColoredPartsCheck | |
| GT2004HeadControl | The GT2004 version of the HeadControl module |
| GT2004HeadControlBasicBehavior | Base class for all basic behaviors in the GT2004HeadControl |
| GT2004HeadControlBasicBehaviors | Creates and registers the basic behaviors |
| GT2004HeadControlSymbols | The Xabsl2 symbols that are defined in "symbols.xml" |
| GT2004HeadPathPlanner | Calculate a smooth series of head joint angles from a gives set of way points and an overall duration |
| GT2004ImageProcessor | The lines image processor recognizes characteristic lines in the image |
| GT2004LEDControl | ATH LED control module for the German Open 2004 |
| GT2004MotionControl | The default solution for the module MotionControl |
| GT2004ObstaclesLocator | This class is a locator for obstacles |
| GT2004Parameters | Parameters for GT2004WalkingEngine |
| GT2004ParametersSet | ParametersSet for GT2004WalkingEngine |
| GT2004PlayersLocator | This class is a locator for players of the own and the opponentīs team |
| GT2004PotentialFieldBasicBehavior | An abstract base class for all potential field based basic behaviors |
| GT2004PotentialFieldBasicBehaviorGoToPose | |
| GT2004PotentialFieldBasicBehaviorOffensiveSupport | |
| GT2004PotentialFieldBasicBehaviors | |
| GT2004PotentialFieldBasicBehaviorSupport | |
| GT2004RobotStateDetector | |
| GT2004SelfLocator | The class implements a lines-based Monte Carlo self-localization |
| GT2004SelfLocator::Cell | The class represents a cell in a cube that is used to determine the largest sample cluster |
| GT2004SelfLocator::Sample | The class represents a sample |
| GT2004SensorDataProcessor | The default SensorDataProcessor in the GT2004 project |
| GT2004SensorDataProcessor::SensorDataRingBuffer | Stores values of SensorData for averaging |
| GT2004SimpleBasicBehaviors | |
| GT2004SoundControl | The default solution of the SoundControl module |
| GT2004StrategySymbols | The Xabsl2 symbols that are defined in "strategy-symbols.xml" |
| GT2004TeamBallLocator | A simple solution of the TeamBallLocator module |
| GT2004WalkingEngine | Walking engine based on calculation of rectangular foot movement and inverse kinematics |
| GTStandardConverter | A class to use the PotentialfieldComposition inside the GT2004 architecture |
| GTXabsl2ActiveOption | |
| GTXabsl2EngineExecutor | Executes an Xabsl2Engine in the GT - architecture |
| GTXabsl2ErrorHandler | Implements Xabsl2ErrorHandler using the OUTPUT macro |
| GTXabsl2LogEntry | Class for keeping numerical activation paths and framenumbers |
| GTXabsl2Profiler | Class for profiling and analysis of Xabsl-Activation-Paths |
| GTXabsl2ProfilerNameTable | |
| GTXabsl2ProfilerNameTableEntry | |
| HeadAndTailSymbols | The Xabsl2 symbols that are defined in "head-and-tail-symbols.xml" |
| HeadControl | A generic class for HeadControl modules |
| HeadControlInterfaces | The interfaces of the HeadControl module |
| HeadControlMode | Stores head modes requested by BehaviorControl |
| HeadControlSelector | HeadControl selection module |
| HeadMotionRequest | Represents a motion request for the head |
| Histogram | A struct to represent histograms |
| horLinePair | |
| Image | Platform independend definition of an image class |
| ImageInfo | Additional information about the current image, computed by the ImageProcessor |
| ImageProcessor | The base class for image processors |
| ImageProcessorInterfaces | The interfaces of the ImageProcessor module |
| ImageProcessorSelector | ImageProcessor selection module |
| Images | Contains IDs for different (debug) image types as well as a method to output their names |
| ImageSaver | |
| In | The class In is the abstract base class for all classes that implement reading from streams |
| InBinary | Formated reading of binary data to be used in streams |
| InBinaryFile | A binary stream from a file |
| InBinaryMemory | A Binary Stream from a memory region |
| InBinaryMessage | A binary stream from a message queue |
| InConfig | The class InConfig reads text data from config (file) streams that contain comments and sections |
| InConfigFile | A config-file-style-formated text stream from a file |
| InConfigMemory | A config-file-style-formated text stream from a memory region |
| InConfigMessage | A config-file-style text stream from a message queue |
| Individual | This is a base class for all parameters sets we want to use in evolution |
| InFile | An PhysicalInStream that reads the data from a file |
| IniFile | Key/Value based .INI-File handling |
| IniFile::lt_nocase | |
| InMemory | An PhysicalInStream that reads the data from a memory region |
| InMessage | An Interface for reading single messages from a MessageQueue that is used by MessageHandler derivates |
| InMessageQueue | A PhysicalInStream that reads the data from a MessageQueue |
| InstanceGroup | A container for temporary storage of a group of object instances |
| InStream< S, R > | Generic class for classes that do both formated and physical reading of data from streams |
| InText | Formated reading of text data to be used in streams |
| InTextFile | A binary stream from a file |
| InTextMemory | A Binary Stream from a memory region |
| InTextMessage | A text stream from a message queue |
| InvKinWalkingEngine | Walking engine based on calculation of rectangular foot movement and inverse kinematics |
| InvKinWalkingParameters | Parameters for InvKinWalkingEngine |
| InvKinWalkingParameters::CorrectionValues | Factors to convert requested body speed to internal leg speed these values are read from odometry.cfg |
| IPEndpoint | This class is used to encapsule ANT library entpoints |
| JointData | One joint data set |
| JointDataBuffer | A buffer for joint data sets, containing all frames computed in one call of Motion::execute |
| JointDataSequence | The JointDataSequence is a sequence of joint data sets with timing and interpolation information |
| JointDataSequencer | A class executing JointDataSequences |
| JoystickData | A class for holdung all data produced by a joystick or a key equivalent |
| JoystickSymbols | The Xabsl2 symbols that are defined in "joystick-symbols.xml" |
| JPEGImage | Definition of a class for JPEG-compressed images |
| JPEGImage::DestDescriptor | The class is required during JPEG-compression to access the main JPEGImage object from library handlers |
| KalmanBallState | Contains the supposed ball state |
| KalmanConstantSpeedModel | Contains a KalmanBallLocator process model for balls with constant speed |
| KalmanFixedPositionModel | Contains a KalmanBallLocator process model for non-moving balls |
| KalmanPredictResult | Contains the results of a predict call of a KalmanBallLocator process model |
| KalmanProcessModelBase | Virtual base class defining the functions necessary to implement a KalmanBallLocator process model |
| KalmanUpdateResult | Contains the results of an update call of a KalmanBallLocator process model |
| KickCase | Represents the results and the preconditions of a single kick experiment |
| KickLogger | Runs in parallel to a xabsl behavior control and logs the preconditions and results of each kick |
| KickSelectionSymbols | The Xabsl2 symbols that are defined in "kick-selection-symbols.xml" |
| KickSelectionTable | |
| Kinematics | Provides Methods for robots kinematic calculations |
| Landmark | Points that can act as landmarks! For the goal and the corner posts these points (in 3D) lie on the top-most point of the landmarks |
| LandmarksPercept | The class represents all detected landmark percepts |
| LandmarksState | A class describing detected landmarks |
| LandmarkState | A class describing a landmark |
| LEDAndSoundSymbols | The Xabsl2 symbols that are defined in "led-and-sound-symbols.xml" |
| LEDControl | A generic class for LED control modules |
| LEDControlInterfaces | Interfaces of the LEDControl Module |
| LEDControlSelector | LEDControl selection module |
| LEDRequest | LED settings requested by BehaviorControl |
| LEDValue | Description of LED value data |
| LightingChangeTester | The LightingChangeTester checks if the lighting has changed |
| Line | A class representing a line |
| LinearFunction | A class representing a linear function in a potential field f(x) = a*x +b |
| LinePair | |
| LinePair2 | |
| LinePair3 | |
| LinesPercept | The class represents a percepted line on the field with its type and a Vector of points belonging to it |
| LinesPercept::LinePoint | |
| LinesTables2004 | The class implements a lines-based Monte Carlo self-localization |
| List< T > | The class implements double linked lists for arbitrary data types |
| List< T >::Data | A struct for list nodes |
| List< T >::Pos | The local class implements a list iterator |
| listed< T > | Implementation of slist : all the objects to be listed must derive from the template class "listed" (use the name of the class as template parameter for normal use) |
| Location | Class for location dependent configuration |
| Logger | A process for logging sensor data |
| LogPlayer | A message queue that can record and play logfiles |
| LowResImage | Definition of a class for streaming images in low resolution i.e |
| MathFunctions | The Xabsl2 symbols that are defined in "math-functions.xml" |
| Matrix2x2< V > | This class represents a 2x2-matrix |
| Matrix3x3< V > | This class represents a 3x3-matrix |
| Matrix_nxn< T, N > | Represents a nxn matrix of type T |
| Maximum | Represents a maximum in the grid |
| MessageHandler | Responsible for distribution of incoming messages |
| MessageQueue | A queue for size varying, time stamped and type safe messages |
| MessageQueueBase | The platform dependend base of class MessageQueue |
| Module | Base class for all modules |
| ModuleHandler | Manages runtime exhangeable modules |
| ModuleSelector | Base class for module selectors |
| Motion | A process for actorics |
| MotionControl | A generic class for motion control modules |
| MotionControlInterfaces | The interfaces of the MotionControl module |
| MotionControlSelector | A module selector for motion control modules |
| Motionfield | A class for computing a motion by using a potential field |
| MotionInfo | Contains information about the motions which are executed by the Motion process |
| MotionNetData | MotionNetData encapsulates all the motion data in the motion net |
| MotionNetNode | Represents a node of the motion net |
| MotionRecognition | |
| MotionRequest | This describes the MotionRequest |
| MotionRequestSymbols | The Xabsl2 symbols that are defined in "motion-request-symbols.xml" |
| MotionStabilizer | Class/function that tries to stabilize the robot in such a way that no forces other then gravity act on the center of mass (or wherever the acceleration sensor is placed) |
| MotorCommands | A class representing a motor commands vector |
| MotorCommandsSender | This class implements a sender for motor commands |
| MSH2004BackwardsWalkingParameters | |
| MSH2004InvKinWalkingEngine | |
| MSH2004WalkingParameters | |
| MultiDebugSender< T > | This template class implements a sender for debug packages |
| MVException | Contains information about an excpetion that occured during calculations |
| NetDebugSender | Special NetSender for MessageQueues |
| NetHandler | Base-class for TCPHandler and UDPHandler |
| NetReceiver< T > | Template-Class to read a package from network and call the streaming-operator for it |
| NetReceiverBase | Template-Independent part of the NetReceiver handles memory-acclocation |
| NetSender< T > | Template class for NetSender |
| NetSenderBase | Base class for NetSenders |
| NoFunction | A class representing an empty function |
| NoGeometry | A class representing an empty geometric object |
| NoOdometrySelfLocator | Class for self-localization based on SingleLandmarks without odometry |
| NoTransformation | Describes no transformation ;-) |
| Object | A class representing an object in a potential field |
| ObjectStateDescription | Describes the state of dynamic objects in a potential field |
| ObservationTable< xSize, ySize, cellSize > | The class realizes a table of closest distances to lines of a certain type |
| ObservationTableBase | The class is a helper to support streaming of template class ObservationTable |
| ObstacleAvoiderOnGreenField | Class that generates Motion requests in a fashion similar to the Braitenberg but also uses the PSD sensor to not run into things |
| ObstacleAvoiderOnGreenFieldERS7 | Class that generates Motion requests in a fashion similar to the Braitenberg but also uses the PSD sensor to not run into things |
| ObstaclesLocator | The Base class for obstacle locators |
| ObstaclesLocatorInterfaces | The interfaces of the ObstaclesLocator module |
| ObstaclesLocatorSelector | |
| ObstaclesModel | A class describing the distance to obstacles around the robot, |
| ObstaclesPercept | The class represents perceived obstacles on the field |
| ObstaclesSymbols | The Xabsl2 symbols that are defined in "obstacles-symbols.xml" |
| OC | |
| OCBridge | A class that contains data of the bridge for the openchallenge |
| OCRedLine | A class that contains data of the bridge's red line for the open challenge |
| OdometryData | OdometryData OdometryData contains an approximation of overall movement the robot has done |
| OdometrySelfLocator | Class for self-localization based on odometry |
| OpenChallengeSymbols | |
| OptionRating | The Base class for option rating |
| Out | The class Out is the abstract base class for all classes that implement writing into streams |
| OutBinary | Formats data binary to be used in streams |
| OutBinaryFile | A binary stream into a file |
| OutBinaryMemory | A binary stream into a memory region |
| OutBinaryMessage | A binary stream into a message queue |
| OutBinarySize | A binary stream size counter |
| OutFile | An PhysicalOutStream that writes the data to a file |
| OutMemory | A PhysicalOutStream that writes the data to a memory block |
| OutMessage | An Interface for writing messages into a MessageQueue |
| OutMessageQueue | A PhysicalOutStream that writes the data to a MessageQueue |
| OutSize | A PhysicalOutStream that doesn't write any data |
| OutStream< S, W > | Generic class for classes that do both formating and physical writing of data to streams |
| OutText | Formats data as text to be used in streams |
| OutTextFile | A text stream into a file |
| OutTextMemory | A text stream into a memory region |
| OutTextMessage | A text stream into a message queue |
| OutTextRaw | Formats data as raw text to be used in streams |
| OutTextRawFile | A text stream into a file |
| OutTextRawMemory | A text stream into a memory region |
| OutTextRawMessage | A text stream into a message queue |
| OutTextRawSize | A Text stream size counter |
| OutTextSize | A Text stream size counter |
| PackageCognitionMotion | Contains all data that are sent from the Cognition process to the Motion process in the CMD process layout |
| PackageMotionCognition | Contains all data that are sent from the Motion process to the Cognition process in the CMD process layout |
| ParabolicFunction | A class representing a parabolic function in a potential field f(x) = a*x*x +b |
| ParamInvKinWalkingEngine | This class is a wrapper for the InvKinWalkingEngine calling a given instance of the engine with a specific set of parameters |
| ParamRearOnlyInvKinWalkingEngine | This class is a wrapper for the InvKinWalkingEngine calling a given instance of the engine with a specific set of parameters |
| Parcour | Contains a walking parcour with all relevant data to calculate next useful MotionRequest, resulting fitness, .. |
| Parser | The parser for PotentialfieldComposition |
| Permutation | The class Permutation defines a method to calculate permutations |
| PfieldGeometricObject | Abstract base class for geometric objects used by potentialfields |
| PfPose | A class to describe the pose of an object in a potential field |
| PfVec | A simple vector with two double components |
| PhysicalInStream | The base class for physical in streams |
| PhysicalOutStream | The base class for physical out streams |
| PIDData | PID data set |
| PIDsmoothedValue | Calculation of the PID-value for a given target value, with or without boundary checks |
| PlatformProcess | This class is the platform dependent base class for all processes |
| Player | A class that represents the team color and player number of the robot |
| PlayerPose | This class contains the informations about the PlayerPose of a located robot |
| PlayerPoseCollection | This class contains the PlayerPoses of all detected robots |
| PlayersLocator | The Base class for player locators |
| PlayersLocatorInterfaces | The interfaces of the PlayersLocator module |
| PlayersLocatorSelector | PlayersLocator selection module |
| PlayersPercept | This is a collection of SinglePlayerPercept for red and blue dressed robots |
| Points3D | A ring buffer for 3 dimensional points relative to the robot that can be moved in x,y by odometry |
| PointsWithValidityAndAge | Represents a set of points on the field |
| Polygon | A class representing a convex polygon |
| Population< T, siz > | Contains a population of parameter sets derived from class Individual |
| Pose2D | Representation for 2D Transformation and Position (Location + Orientation) |
| Pose3D | Representation for 3D Transformation (Location + Orientation) |
| PoseSample | The class represents a pose sample |
| Potentialfield | An abstract base class for all fields |
| PotentialfieldAStarNode | A class describing a node in an A* search tree |
| PotentialfieldAStarParameterSet | A class for all parameters for A* search |
| PotentialFieldBasicBehaviors | Creates and registers potential field basic behaviors |
| PotentialfieldComposition | The main class for the potential field implementation |
| PotentialfieldFunction | An abstract class representing a function in a potential field |
| PotentialfieldResult | Describes the result of a potential field |
| PotentialfieldTransformation | Abstract class, describing a transformation |
| Process | System independent base class for Processes |
| ProcessBase | The class is a helper that allows to instantiate a class as an Aperios process |
| ProcessCreator< T > | The class is a helper that allows to instantiate a class as an Aperios process |
| PropagatedBallPosition | The position of the ball estimated from own observations and the observed ball speed; it is propagated even if the ball is not seen |
| PSDPercept | Class containg all single PSD spots perceived in one frame |
| QueueFillRequest | Request to fill DebugQueues with a certain QueueFillMode |
| RandomMotionGenerator | An class for generating random motion vectors |
| Range< T > | A template class to represent ranges |
| RangeArray< T > | A template class to represent arrays of ranges |
| RasterImageProcessor | A class for image-processing |
| RasterSpecialist | Base-class for RasterSpecialists |
| RasterSpecialist::Box | This class represents a BoundingBox in the image |
| RasterSpecialist::ColoredLP | Four colors for the vector2 begin and end representing in/out colors 0 and 1 should be v1-in and v1-out, same for 2 and 3 v2-in and v2-out |
| RasterSpecialist::GridLP | Holds also information about the position in a grid |
| RasterSpecialist::LineCompare | |
| RasterSpecialist::LinePair | This struct represents a line on the image |
| RasterSpecialist::ListSizeOrder | |
| RasterSpecialist::SegmentNumberOrder | |
| RasterSpecialist::VectorSizeOrder | |
| RasterStrategy | Base-class for RasterStrategies |
| RateableOptions | The class contains an enumeration of rateable options |
| RateableOptions::OptionInfo | |
| RBallSpecialist2 | Implements a detection algorithm for balls |
| RBridgeSpecialist | |
| RBridgeSpecialist::Rectangle | Struct that represents a rectangle |
| RBridgeSpecialist::SegmentInfo | This struct holds information about a segment in the image |
| RDefaultStrategy | Default-implementation of RasterStrategy |
| Receiver< T > | The class implements a receiver |
| ReceiverList | The class is the base class for receivers |
| REdgeDetection | Utility-class for edge-detection |
| RelativeFormation | A class representing a formation relative to another object |
| REnemySpecialist | |
| RFieldSpecialist | This class regognizes lines on the field, and the intersection of them |
| RFieldSpecialist::processParam | This structure contains important parameters for the line recognition: |
| RFieldStateMachine | This class represents a deterministic state machine |
| RingBuffer< V, n > | Template class for cyclic buffering of the last n values of Type V |
| RingBufferWithSum< n > | Template class for cyclic buffering of the last n values of Type int and with a function that returns the sum of all entries |
| RoboCupGameManagerSymbols | The Xabsl2 symbols that are defined in "robocup-game-manager-symbols.xml" |
| RobotCalibration | A class that represents the calibration of the robot |
| RobotConfiguration | A class that represents the configuration of the robot |
| RobotDesign | |
| RobotDimensions | |
| RobotDimensionsERS210 | |
| RobotDimensionsERS7 | |
| RobotPose | A Pose2D with validity |
| RobotPoseSymbols | The Xabsl2 symbols that are defined in "robot-pose-symbols.xml" |
| RobotState | A class describing detected button messages and whether robot is crashed |
| RobotStateDetector | The Base class for robot state detection |
| RobotStateDetectorInterfaces | The interfaces of the RobotStateDetector module |
| RobotStateDetectorSelector | RobotStateDetector selection module |
| RobotStateSymbols | The Xabsl2 symbols that are defined in "robot-state-symbols.xml" |
| RobotVertices | The RobotVertices struct contains the 3D position of important points of the robot like the shoulder, knee and foot positions |
| Rotation | Describes a rotation |
| RotationMatrix | Representation for 3x3 RotationMatrices |
| Run | Describes a sequence of pixels of the same colour |
| SampleSet< T, N > | A container for samples |
| SampleSetProxy< T > | The SampleSetProxy can be linked to instances of the class SampleSet |
| SampleSetProxyBase | The base of class SampleSetProxy |
| Sector | A class representing a sector |
| SeenBallPosition | The knowledge about the ball that was obtained by own observations |
| SelfLocator | The Base class for self locators |
| SelfLocatorInterfaces | The interfaces of the SelfLocator module |
| SelfLocatorSelector | SelfLocator selection module |
| Sender< T > | The class implements the default sender for packages |
| SenderBase< T > | The class implements a the base class for senders |
| SenderList | The class is the base class for senders |
| SensorBehaviorControl | A generic class for Modules which generate motionRequests by sensorData |
| SensorBehaviorControlInterfaces | The interfaces of the SensorBehaviorControl module |
| SensorBehaviorControlSelector | A module selector for sensor data to motion request modules |
| SensorData | A class representing a sensor data vector |
| SensorDataBuffer | A buffer for sensor data sets, containing all frames received at the same time |
| SensorDataProcessor | An abstract class that defines a processor for raw sensor data |
| SensorDataProcessorInterfaces | Interfaces of the SensorDataProcessor module |
| SensorDataProcessorSelector | A module selector for sensor data processors |
| Sensors | Base class for sensor processes |
| SimpleBackwardParcour | Contains a special walking parcour |
| SimpleBasicBehaviors | Creates and registers simple basic behaviors |
| SimpleMotionRecognition | |
| SingleBeliefs | The class contains information on how the robot senses his enviroment |
| SingleFormation | An abstract class representing a simple formation |
| SinglePlayerPercept | This class contains some information about a single perceived robot |
| SinglePSDPercept | A spot relative to the robot that was detected by the PSD Sensor |
| SlidingAverageValue | Class for cyclic buffering of the last "size" values of Type int output via = operator is the average of the last "size" values input a new value also via = operator ATTENTION: the "current-index" is driven by the trigger, so the given average is an average over the last "size" trigger-events ! |
| slist< T > | |
| slist< T >::iterator | |
| SocialFunction | A class representing a social function in a potential field |
| SolutionRequest | Manages runtime exhangeable modules |
| SoundControl | A generic class for SoundControl modules |
| SoundControlInterfaces | Interfaces of the SoundControl module |
| SoundControlSelector | A module selector for sound control modules |
| SoundData | The SoundData is a non NDA violating description of Sound Vector data |
| SoundDataSender | This class implements a sender for sound data |
| SoundRequest | Represents an acoustic message |
| SpecialActionRequest | |
| SpecialActions | A generic class for SpecialActions |
| SpecialActionsInterfaces | Interfaces of the SpecialAction module |
| SpecialLandmark | |
| SpecialPercept | A class that contains a certain specialPercept |
| SpecialPerceptSelfLocator | Class for self-localization based on special percepts, e.g |
| SpecialVision | The base class for special vision modules |
| SpecialVisionInterfaces | The interfaces of the module SpecialVision |
| SpecialVisionRequest | Represents a request for special visons (challenges ...) |
| SpecialVisionSymbols | The Xabsl2 symbols that are defined in "special-vision-symbols.xml" |
| Statistics | The class does some statistics on the number of individuals drawn |
| Stopwatch | Provides IDs and names for different stopwatch tasks; makros are used to provide real stopwatch functionality with that |
| StreamReader | Generic class for formated reading of data to be used in streams |
| StreamWriter | Generic class for formating data to be used in streams |
| SUSANEdgeDetectionLite | This class represents a non-linear image edge detection filter |
| SystemCall | Static class for system calls - Attention:
- the implementation is system specific!
|
| TacticChooser | The Base class for tactic choosing |
| TacticEntry | The class contains the information needed for one TacticEntry |
| TacticEntryArray | The class contains an array of TacticEntrys |
| TailRequest | |
| TCPEndpoint | Handels a TCP-Connection |
| TCPHandler | The associated sender first finds out the size of the data to send and streams the data into a memory buffer |
| TeamBallLocator | The Base class for team ball locators |
| TeamBallLocatorInterfaces | The interfaces of the TeamBallLocator module |
| TeamBallLocatorSelector | A module selector for team ball locators |
| TeamMessage | Represents a collection of all data that is exchanged between the different robots |
| TeamMessage1 | A TeamMessage from team mate 1 |
| TeamMessage2 | A TeamMessage from team mate 2 |
| TeamMessage3 | A TeamMessage from team mate 3 |
| TeamMessage4 | |
| TeamMessageCollection | Represents a collection of all actual team messages received from other robots and has the ability to send to them too |
| TemplateTable< TEMPLATES_MAX > | The class realizes a table of template poses |
| TemplateTable< TEMPLATES_MAX >::Temp | The class is required for sorting the template table by the distances to lines |
| TemplateTableBase | The class is a helper to support streaming of template class TemplateTable |
| TestServer | Small testing class for TCP-Endpoinr |
| TransformedRun | Special class for comparing and clustering runs |
| Translation | Describes a translation |
| TurnKickWalkingParameters | Parameters for InvKinWalkingEngine |
| TurnWithBallWalkingParameters | |
| UDPEndpoint | Handles sending and receiving UDP-Packages |
| UDPHandler | |
| UDPHandlerEndpoint | The UDP-Handler and UDPHandlerEndpoint are used sends team communication data via an UDP-based protocol |
| UpsideDownWalkingParameters | Parameters for InvKinWalkingEngine that let robot walk upside down |
| VAPoint | Represents a point on the field |
| VAPoints | Represents a set of points on the field |
| Vector2< V > | This class represents a 2-vector |
| Vector2Sample | The class represents a 2D sample |
| Vector3< V > | This class represents a 3-vector |
| Vector_n< T, N > | Represents a n-dimensional vector of type T |
| WakeUpEngine | |
| WalkAccelerationRestrictor | Provides functionality for restriction changes in walk speed to maximum values |
| WalkingEngine | A generic class for walking engine modules |
| WalkingEngineInterfaces | The interfaces of the module WalkingEngine |
| WalkingEngineSelector | A module selector for WalkingEngine modules |
| WalkRequest | |
| Xabsl2Agent | Combines some options to an agent |
| Xabsl2AndOperator | Represents an 'and' element of the option graph |
| Xabsl2ArithmeticOperator | Base class for the +, -, *, / and operator |
| Xabsl2Array< T > | The class implements a dynamic array |
| Xabsl2ArrayElement< T > | An element of an Xabsl2Array |
| Xabsl2BasicBehavior | The base class for basic behaviors that are used by the XabslEngine |
| Xabsl2BehaviorControl | Base class for all BehaviorControl solutions that use a Xabsl2Engine |
| Xabsl2BehaviorControlAgentInterface | Allows to register the same Xabsl2BehaviorControl instance more than once at a ModuleHandler to be able to switch between different agents using the GT Module mechanism |
| Xabsl2BooleanExpression | Base class for all boolean expressions inside an option graph |
| Xabsl2BooleanInputSymbol | Represents a boolean input symbol of the Xabsl2Engine |
| Xabsl2BooleanInputSymbolRef | Represents an 'boolean-input-symbol-ref' element of the option graph |
| Xabsl2ConditionalExpression | Represents an ANSI C (condition?expression:expression) question mark operator |
| Xabsl2DecimalExpression | Base class for all decimal expressions inside an option graph |
| Xabsl2DecimalInputFunction | Represents a parameterized decimal input function of the Xabsl2Engine |
| Xabsl2DecimalInputFunctionCall | Represents a reference to a decimal input function |
| Xabsl2DecimalInputSymbol | Represents a decimal input symbol of the Xabsl2Engine |
| Xabsl2DecimalInputSymbolRef | Represents a reference to a decimal input symbol |
| Xabsl2DecimalValue | Represents a decimal value |
| Xabsl2DivideOperator | Represents a / operator in the option graph |
| Xabsl2Engine | Executes a behavior that was specified in the Xabsl language |
| Xabsl2EnumElement | Represents an enum element that is part of an enumerated input or output symbol |
| Xabsl2EnumeratedInputSymbol | Represents a enumerated input symbol of the Xabsl2Engine |
| Xabsl2EnumeratedInputSymbolComparison | Represents an 'enumerated-input-symbol-comparison' element of the option graph |
| Xabsl2EnumeratedOutputSymbol | Represents a enumerated output symbol of the Xabsl2Engine |
| Xabsl2EqualToOperator | Represents an 'equal-to' element of the option graph |
| Xabsl2ErrorHandler | A Xabsl2Engine helper class for handling errors and debug messages |
| Xabsl2FileInputSource | Implements Xabsl2InputSource using the InConfigFile class |
| Xabsl2FunctionProvider | Base class for all those classes that want to register functions for symbols at a Xabsl2Engine |
| Xabsl2GreaterThanOperator | Represents an 'greater-than' element of the option graph |
| Xabsl2GreaterThanOrEqualToOperator | Represents an 'greater-than-or-equal-to' element of the option graph |
| Xabsl2HeadControl | Base class for all HeadControl solutions that use a Xabsl2Engine |
| Xabsl2HeadControlAgentInterface | Allows to register the same Xabsl2HeadControl instance more than once at a ModuleHandler to be able to switch between different agents using the GT Module mechanism |
| Xabsl2IfElseBlock | An element of a decision tree that that contains of an if - (else-if) - else block |
| Xabsl2InputSource | A Xabsl2Engine helper class for reading input data from files or from memory |
| Xabsl2InputSymbol< T > | A Template for the input symbol classes |
| Xabsl2LessThanOperator | Represents an 'less-than' element of the option graph |
| Xabsl2LessThanOrEqualToOperator | Represents an 'less-than-or-equal-to' element of the option graph |
| Xabsl2MessageInputSource | Implements Xabsl2InputSource using the InConfigMessage class |
| Xabsl2MinusOperator | Represents a - operator in the option graph |
| Xabsl2ModOperator | Represents a operator in the option graph |
| Xabsl2MultiplyOperator | Represents a * operator in the option graph |
| Xabsl2NamedItem | A class that has a text label |
| Xabsl2NotEqualToOperator | Represents an 'not-equal-to' element of the option graph |
| Xabsl2NotOperator | Represents an 'not' element of the option graph |
| Xabsl2Option | Represents a single option written in Xabsl2 |
| Xabsl2OptionParameterRef | Represents a reference to an option parameter |
| Xabsl2OrOperator | Represents an 'or' element of the option graph |
| Xabsl2PlusOperator | Represents a + operator in the option graph |
| Xabsl2RelationalAndEqualityOperator | Base class for the operators <, <=, >, >=, == and != |
| Xabsl2State | Represents a single state written in Xabsl2 |
| Xabsl2Statement | An element of a decision that that determines a transition to a state |
| Xabsl2subsequentOptionReachedTargetStateCondition | Represents an 'subsequent-option-reached-target-state' element of the option graph |
| Xabsl2Symbols | Handles the symbols of the Xabsl2Engine |
| Xabsl2TimeRef | Represents a time-of-option-execution or time-of-state-execution element in the option graph |
| Xabsl2TransitionToState | Represents a transition to a state inside a decision tree |