 fawkes | Fawkes library namespace |
  openni | |
   HandIfObserver | Hand interface observer |
   SkelIfObserver | Skeleton interface observer |
   UserInfo | User info to pass to draw_skeletons() |
   HandInfo | Hand info to pass to draw_skeletons() |
  pcl_utils | |
   PolygonComparison | Check if point is inside or outside a given polygon |
   PlaneDistanceComparison | Compare points' distance to a plane |
   PointCloudNonDeleter | Helper struct to avoid deletion of PointClouds |
  runtime | |
   InitOptions | Initialization options class |
  tf | |
   TransformException | Base class for fawkes tf exceptions |
   ConnectivityException | No connection between two frames in tree |
   LookupException | A frame could not be looked up |
   ExtrapolationException | Request would have required extrapolation beyond current limits |
   InvalidArgumentException | Passed argument was invalid |
   DisabledException | The requested feature is disabled |
   TransformStorage | Storage for transforms and their parent |
   TimeCache | Time based transform cache |
   TransformListener | Receive transforms and answer queries |
   TransformPublisher | Utility class to send transforms |
   CanTransformAccum | Accumulator to test for transformability |
   TransformAccum | Accumulator to accumulate transforms between two frames |
   TimeAndFrameIDFrameComparator | Time and frame ID comparator class |
   Transformer | Coordinate transforms between any two frames in a system |
   StampedTransform | Transform that contains a timestamp and frame IDs |
   Stamped | Wrapper class to add time stamp and frame ID to base types |
  Aspect | Fawkes aspect base class |
  AspectProviderAspect | Thread aspect provide a new aspect |
  BlackBoardAspect | Thread aspect to access to BlackBoard |
  BlockedTimingExecutor | Blocked timing executor |
  BlockedTimingAspect | Thread aspect to use blocked timing |
  ClockAspect | Thread aspect that allows to obtain the current time from the clock |
  ConfigurableAspect | Thread aspect to access configuration data |
  FawkesNetworkAspect | Thread aspect to participate in the Fawkes Network protocol |
  AspectProviderAspectIniFin | Initializer/finalizer for the AspectProviderAspect |
  BlackBoardAspectIniFin | Initializer/finalizer for the BlackBoardAspect |
  BlockedTimingAspectIniFin | Initializer/finalizer for the BlockedTimingAspect |
  ClockAspectIniFin | Initializer/finalizer for the ClockAspect |
  ConfigurableAspectIniFin | Initializer/finalizer for the ConfigurableAspect |
  FawkesNetworkAspectIniFin | Initializer/finalizer for the FawkesNetworkAspect |
  AspectIniFin | Aspect initializer/finalizer base class |
  LoggerAspectIniFin | Initializer/finalizer for the LoggerAspect |
  LoggingAspectIniFin | Initializer/finalizer for the LoggingAspect |
  MainLoopAspectIniFin | Initializer/finalizer for the MainLoopAspect |
  NetworkAspectIniFin | Initializer/finalizer for the NetworkAspect |
  PluginDirectorAspectIniFin | Initializer/finalizer for the PluginDirectorAspect |
  PointCloudAspectIniFin | Initializer/finalizer for the PointCloudAspect |
  TransformAspectIniFin | Initializer/finalizer for the TransformAspect |
  ThreadProducerAspectIniFin | Initializer/finalizer for the ThreadProducerAspect |
  TimeSourceAspectIniFin | Initializer/finalizer for the TimeSourceAspect |
  VisionAspectIniFin | Initializer/finalizer for the VisionAspect |
  VisionMasterAspectIniFin | Initializer/finalizer for the VisionMasterAspect |
  WebviewAspectIniFin | Initializer/finalizer for the WebviewAspect |
  LoggerAspect | Thread aspect that allows to provide a logger to Fawkes |
  LoggingAspect | Thread aspect to log output |
  MainLoopEmployer | Main loop employer The MainLoopEmployer calls the main loop for execution |
  MainLoopAspect | Thread aspect that allows to replace the main loop of the main application of Fawkes |
  AspectManager | Aspect and aspect initializer/finalizer manager |
  NetworkAspect | Thread aspect for network communication |
  PluginDirectorAspect | Thread aspect to access the PluginManager |
  PointCloudTimestamp | Union to pack fawkes::Time into the pcl::PointCloud timestamp |
  PointCloudManager | Point Cloud manager |
   PointCloudStorageAdapter | Adapter class for PCL point types |
   StorageAdapter | Adapter base class |
  PointCloudAspect | Thread aspect to provide and access point clouds |
  TransformAspect | Thread aspect to access the transform system |
  ThreadProducerAspect | Aspect for thread producing threads |
  TimeSourceAspect | Thread aspect that allows to provide a time source to the Fawkes clock |
  VisionAspect | Thread aspect to use in FireVision apps |
  VisionMasterAspect | Vision Master Aspect |
  WebviewAspect | Thread aspect to provide web pages via Webview |
  FawkesMainThread | Fawkes default main thread |
   Runner | Utility class to run the main thread |
  ThreadManager | Base application thread manager |
  BlackBoard | The BlackBoard abstract class |
  BlackBoardMemMgrInvalidPointerException | A NULL pointer was supplied where not allowed |
  BBInconsistentMemoryException | Thrown when BlackBoard memory has been corupted This exception is thrown by the memory manager if the memory has been corrupted, for example if there are bytes that belong to neither a free chunk nor a allocated chunk |
  BBNotMasterException | Thrown if BlackBoard is not master and master operation has been requested |
  BBMemMgrCannotOpenException | Thrown if shared memory could not be opened |
  BlackBoardInterfaceNotFoundException | Thrown if no definition of interface or interface generator found |
  BlackBoardInterfaceVersionMismatchException | Thrown if versions do not match |
  BlackBoardWriterActiveException | Thrown if a writer is already active on an interface that writing has been requested for |
  BlackBoardNoMasterAliveException | Thrown if BlackBoard is opened as non-master with no master alive |
  BlackBoardNoWritingInstanceException | Thrown if no writer interface is alive |
  BlackBoardInterfaceListener | BlackBoard interface listener |
   InterfaceMaps | Structure to hold maps for active subscriptions |
   QueueEntry | Queue entry type |
  BlackBoardInterfaceObserver | BlackBoard interface observer |
  BlackBoardInstanceFactory | BlackBoard instance factory |
  BlackBoardInterfaceManager | BlackBoard interface manager |
  interface_header_t | This struct is used as header for interfaces in memory chunks |
  chunk_list_t | Chunk lists as stored in BlackBoard shared memory segment |
  BlackBoardMemoryManager | BlackBoard memory manager |
   ChunkIterator | Iterator for memory chunks |
  BlackBoardMessageManager | BlackBoard message manager |
  BlackBoardNotifier | BlackBoard notifier |
  LocalBlackBoard | Local BlackBoard |
  BlackBoardNetworkHandler | BlackBoard Network Handler |
  BlackBoardInterfaceListContent | BlackBoard interface list content |
  BlackBoardNetHandlerInterfaceListener | Interface listener for network handler |
  BlackBoardNetHandlerInterfaceObserver | Interface observer for blackboard network handler |
  BlackBoardInterfaceProxy | Interface proxy for remote BlackBoard |
  bb_ilist_msg_t | Message to transport a list of interfaces |
  bb_ilistreq_msg_t | Message to request constrained interface list |
  bb_iopen_msg_t | Message to identify an interface on open |
  bb_iinfo_msg_t | Message for interface info |
  bb_ievent_msg_t | Message for interface events |
  bb_iserial_msg_t | Message to identify an interface instance |
  bb_ieventserial_msg_t | Message to identify an two interface instances |
  bb_iopensucc_msg_t | Interface open success The serial denotes a unique instance of an interface within the (remote) BlackBoard |
  bb_iopenfail_msg_t | Message to send update data |
  bb_idata_msg_t | Interface data message |
  bb_imessage_msg_t | Interface message |
  RemoteBlackBoard | Remote BlackBoard |
  BlackBoardSharedMemoryHeader | BlackBoard Shared Memory Header |
  BlackBoardSharedMemoryLister | BlackBoard shared memory lister |
  ConfigurationChangeHandler | Interface for configuration change handling |
  ConfigurationException | Generic configuration exception |
  ConfigEntryNotFoundException | Thrown if a config entry could not be found |
  ConfigTypeMismatchException | Thrown if there a type problem was detected for example if you tried to query a float with get_int() |
  CouldNotOpenConfigException | Thrown if config could not be opened |
  Configuration | Interface for configuration handling |
   ValueIterator | Iterator interface to iterate over config values |
  ConfigNetworkHandler | Fawkes Configuration Network Handler |
  ConfigListContent | Config list content |
  config_descriptor_t | Basic config descriptor |
  config_getval_msg_t | Get value message |
  config_invval_msg_t | Invalid value request message |
  config_erase_value_msg_t | Erase value request |
  config_value_erased_msg_t | Value erased message |
  config_float_value_msg_t | Float value message |
  config_uint_value_msg_t | Unsigned int value message |
  config_int_value_msg_t | Integer value message |
  config_bool_value_msg_t | Boolean value message |
  config_string_value_msg_t | String value message |
  config_comment_msg_t | Comment message |
  config_tag_msg_t | Tag message |
  config_list_msg_t | Config list message |
  config_list_entity_header_t | Config list entity header |
  config_list_float_entity_t | Config list float entity |
  config_list_uint_entity_t | Config list unsigned int entity |
  config_list_int_entity_t | Config list int entity |
  config_list_bool_entity_t | Config list bool entity |
  config_list_string_entity_t | Config list string entity |
  config_list_comment_entity_t | Config list comment entity |
  CannotEnableMirroringException | Thrown if enabling mirror mode failed |
  NetworkConfiguration | Remote configuration via Fawkes net |
   NetConfValueIterator | Network configuration value iterator |
  SQLiteConfiguration | Configuration storage using SQLite |
   SQLiteValueIterator | SQLite configuration value iterator |
  Exception | Base class for exceptions in Fawkes |
   iterator | Message iterator for exceptions |
   message_list_t | Internal exception message list |
  NullPointerException | A NULL pointer was supplied where not allowed |
  DivisionByZeroException | Division by zero |
  TypeMismatchException | Type mismatch |
  UnknownTypeException | Unknown type |
  DestructionInProgressException | Delete in progress |
  NotLockedException | Operation on unlocked object |
  NonPointerTypeExpectedException | Non-pointer type expected |
  MissingParameterException | Expected parameter is missing |
  IllegalArgumentException | Expected parameter is missing |
  OutOfBoundsException | Index out of bounds |
  AccessViolationException | Access violates policy |
  SyntaxErrorException | Syntax error |
  NotImplementedException | Called method has not been implemented |
  OutOfMemoryException | System ran out of memory and desired operation could not be fulfilled |
  InterruptedException | The current system call has been interrupted (for instance by a signal) |
  TimeoutException | The current system call has timed out before completion |
  CouldNotOpenFileException | File could not be opened |
  FileReadException | File could not be read |
  FileWriteException | Could not write to file |
  Plugin | Plugin interface class |
  Barrier | A barrier is a synchronization tool which blocks until a given number of threads have reached the barrier |
  InterruptibleBarrier | A barrier is a synchronization tool which blocks until a given number of threads have reached the barrier |
  Mutex | Mutex mutual exclusion lock |
  MutexLocker | Mutex locking helper |
  ReadWriteLock | Read/write lock to allow multiple readers but only a single writer on the resource at a time |
  RecursiveMutex | Recursive mutex |
  RefCountRWLock | Read/write lock with reference counting |
  ScopedRWLock | Scoped read/write lock |
  Spinlock | Spin lock |
  LockList | List with a lock |
  Thread | Thread class encapsulation of pthreads |
  ThreadCollector | Thread collector |
  CannotFinalizeThreadException | Thread cannot be finalized |
  ThreadFinalizer | Thread finalizer interface |
  CannotInitializeThreadException | Thread cannot be initialized |
  ThreadInitializer | Thread initializer interface |
  ThreadListSealedException | Thread list sealed exception |
  ThreadListNotSealedException | Thread list not sealed exception |
  ThreadList | List of threads |
  ThreadNotificationListener | Thread notification listener interface |
  WaitCondition | Wait until a given condition holds |
  LockHashMap | Hash map with a lock |
  LockHashSet | Hash set with a lock |
  LockMap | Map with a lock |
  LockMultiMap | Multi-Map with a lock |
  LockQueue | Queue with a lock |
  LockSet | Set with a lock |
  LockVector | Vector with a lock |
  LockPtr | LockPtr<> is a reference-counting shared lockable smartpointer |
  RefCount | Reference counting base class |
  RefPtr | RefPtr<> is a reference-counting shared smartpointer |
  RWLockList | List with a read/write lock |
  RWLockMap | Hash map with a lock |
  RWLockQueue | Queue with a read/write lock |
  RWLockVector | Vector with a lock |
  EclExternalBlackBoard | Wrapper class for using the blackboard in the implementation of the external predicates |
  EclExternalRCSoftMapGraph | Wrapper class for using the RCSoftMapGraph in the implementation of the external predicates |
  Bezier | A Bezier curve class |
  BezierDrawer | Drawer for Bezier objects |
  DrawingManipulator | Allows to control some aspects of the rendering of objects |
  GeomDrawer | Abstract base class for all drawer classes |
  GeomDrawingArea | A Gtk::DrawingArea that allows to easily display drawable objects of the geometry library |
  HomPointDrawer | Drawer for HomPoint objects |
  HomVectorDrawer | Drawer for HomVector objects |
  LineSegmentDrawer | Drawer for LineSegment objects |
  SplineDrawer | Drawer for Spline objects |
  HomCoord | Base class for homogeneous primitives (vector and point) |
  HomPoint | A homogeneous point |
  HomPolar | A homogeneous representation of a polar coordinate |
  HomPose | A homogeneous pose combines a position with an orienation in space |
  HomPose2d | A 2-dimensional pose, i.e |
  HomTransform | This class describes a homogeneous transformation |
  HomVector | A homogeneous vector |
  Line | Well, what can one say about a straight line? |
  LineSegment | A line segment |
  Matrix | A general matrix class |
  Printable | Interface class for printable objects |
  Spline | A spline made up of cubic Bezier curves |
  Transformable | Interface class for all transformable objects |
  Vector | A simple column vector |
  AvahiDispatcher | Avahi dispatcher |
  ConnectionDispatcher | Watches network client events and dispatches them as signals |
  InterfaceChooserDialog | Blackboard interface chooser dialog |
   Record | Blackboard interface record |
  InterfaceDispatcher | Interface listener with dispatcher |
  LogView | Log View widget |
  MultiInterfaceChooserDialog | Blackboard interface chooser dialog that supports multiple choices |
   Record | Blackboard interface record |
  PluginTreeView | A TreeView class to list available plugins und trigger their loading/unloading |
  AllemaniACsAtHomeCairoRobotDrawer | Draw AllemaniACs AtHome robot |
  CairoRobotDrawer | Robot drawing interface |
  ServiceChooserDialog | Service chooser dialog |
  ServiceModel | Abstract base class for widgets that allow to view the detected services of a certain type |
   ServiceAddedRecord | Data structure to hold information about a newly added services |
   ServiceRecord | Detects services and manages information about detected services |
   ServiceRemovedRecord | Data structure to hold information about a recently removed services |
  ServiceSelectorCBE | This widget consists of a Gtk::ComboBox and a Gtk::Button |
  Throbber | Simple Gtk Throbber/Spinner |
  TwoLinesCellRenderer | Gtk cell renderer for two lines of text in a cell |
  InterfaceFieldIterator | Interface field iterator |
  InterfaceFieldPointer | Direct pointer to an interface field |
  InterfaceWriteDeniedException | This exception is thrown if a write has been attempted on a read-only interface |
  InterfaceMessageEnqueueException | This exception is thrown if a write has been attempted on a read-only interface |
  InterfaceInvalidMessageException | This exception is thrown if a message has been queued in the interface which is not recognized by the interface |
  InterfaceInvalidException | This exception is thrown if an interface is invalid and it is attempted to call read()/write() |
  Interface | Base class for all Fawkes BlackBoard interfaces |
   interface_data_ts_t | Timestamp data, must be present and first entries for each interface data structs! This leans on timeval struct |
   interface_messageinfo_t | Message info list |
  InterfaceInfo | Interface info |
  InterfaceInfoList | Interface information list |
  InterfaceMediator | Interface mediator interface |
  MessageMediator | Message mediator interface |
  Message | Base class for all messages passed through interfaces in Fawkes BlackBoard |
   message_data_ts_t | Timestamp data, must be present and first entries for each interface data structs! This leans on timeval struct |
  MessageAlreadyQueuedException | Message already enqueued exception |
  MessageQueue | Message queue used in interfaces |
   MessageIterator | Message iterator |
  interface_fieldinfo_t | Interface field info list |
  BatteryInterface | BatteryInterface Fawkes BlackBoard Interface |
   PushButtonMessage | PushButtonMessage Fawkes BlackBoard Interface Message |
   SleepMessage | SleepMessage Fawkes BlackBoard Interface Message |
  FacerInterface | FacerInterface Fawkes BlackBoard Interface |
   EnableIdentityMessage | EnableIdentityMessage Fawkes BlackBoard Interface Message |
   GetNameMessage | GetNameMessage Fawkes BlackBoard Interface Message |
   LearnFaceMessage | LearnFaceMessage Fawkes BlackBoard Interface Message |
   SetNameMessage | SetNameMessage Fawkes BlackBoard Interface Message |
   SetOpmodeMessage | SetOpmodeMessage Fawkes BlackBoard Interface Message |
  FacialExpressionInterface | FacialExpressionInterface Fawkes BlackBoard Interface |
   MoveBrowsMessage | MoveBrowsMessage Fawkes BlackBoard Interface Message |
   MoveEyesMessage | MoveEyesMessage Fawkes BlackBoard Interface Message |
   MoveJowlMessage | MoveJowlMessage Fawkes BlackBoard Interface Message |
   MoveMouthMessage | MoveMouthMessage Fawkes BlackBoard Interface Message |
  GameStateInterface | GameStateInterface Fawkes BlackBoard Interface |
   SetKickoffMessage | SetKickoffMessage Fawkes BlackBoard Interface Message |
   SetStateTeamMessage | SetStateTeamMessage Fawkes BlackBoard Interface Message |
   SetTeamColorMessage | SetTeamColorMessage Fawkes BlackBoard Interface Message |
  HumanoidMotionInterface | HumanoidMotionInterface Fawkes BlackBoard Interface |
   GetUpMessage | GetUpMessage Fawkes BlackBoard Interface Message |
   KickMessage | KickMessage Fawkes BlackBoard Interface Message |
   MoveHeadMessage | MoveHeadMessage Fawkes BlackBoard Interface Message |
   ParkMessage | ParkMessage Fawkes BlackBoard Interface Message |
   StandupMessage | StandupMessage Fawkes BlackBoard Interface Message |
   StopMessage | StopMessage Fawkes BlackBoard Interface Message |
   TurnMessage | TurnMessage Fawkes BlackBoard Interface Message |
   WalkArcMessage | WalkArcMessage Fawkes BlackBoard Interface Message |
   WalkSidewaysMessage | WalkSidewaysMessage Fawkes BlackBoard Interface Message |
   WalkStraightMessage | WalkStraightMessage Fawkes BlackBoard Interface Message |
   WalkVelocityMessage | WalkVelocityMessage Fawkes BlackBoard Interface Message |
  HumanSkeletonInterface | HumanSkeletonInterface Fawkes BlackBoard Interface |
  HumanSkeletonProjectionInterface | HumanSkeletonProjectionInterface Fawkes BlackBoard Interface |
  JoystickInterface | JoystickInterface Fawkes BlackBoard Interface |
   StartRumbleMessage | StartRumbleMessage Fawkes BlackBoard Interface Message |
   StopAllMessage | StopAllMessage Fawkes BlackBoard Interface Message |
   StopRumbleMessage | StopRumbleMessage Fawkes BlackBoard Interface Message |
  KatanaInterface | KatanaInterface Fawkes BlackBoard Interface |
   CalibrateMessage | CalibrateMessage Fawkes BlackBoard Interface Message |
   CloseGripperMessage | CloseGripperMessage Fawkes BlackBoard Interface Message |
   FlushMessage | FlushMessage Fawkes BlackBoard Interface Message |
   LinearGotoKniMessage | LinearGotoKniMessage Fawkes BlackBoard Interface Message |
   LinearGotoMessage | LinearGotoMessage Fawkes BlackBoard Interface Message |
   MoveMotorAngleMessage | MoveMotorAngleMessage Fawkes BlackBoard Interface Message |
   MoveMotorEncoderMessage | MoveMotorEncoderMessage Fawkes BlackBoard Interface Message |
   ObjectGotoMessage | ObjectGotoMessage Fawkes BlackBoard Interface Message |
   OpenGripperMessage | OpenGripperMessage Fawkes BlackBoard Interface Message |
   ParkMessage | ParkMessage Fawkes BlackBoard Interface Message |
   SetEnabledMessage | SetEnabledMessage Fawkes BlackBoard Interface Message |
   SetMaxVelocityMessage | SetMaxVelocityMessage Fawkes BlackBoard Interface Message |
   SetMotorAngleMessage | SetMotorAngleMessage Fawkes BlackBoard Interface Message |
   SetMotorEncoderMessage | SetMotorEncoderMessage Fawkes BlackBoard Interface Message |
   SetPlannerParamsMessage | SetPlannerParamsMessage Fawkes BlackBoard Interface Message |
   StopMessage | StopMessage Fawkes BlackBoard Interface Message |
  KickerInterface | KickerInterface Fawkes BlackBoard Interface |
   GuideBallMessage | GuideBallMessage Fawkes BlackBoard Interface Message |
   KickMessage | KickMessage Fawkes BlackBoard Interface Message |
   ResetCounterMessage | ResetCounterMessage Fawkes BlackBoard Interface Message |
  Laser360Interface | Laser360Interface Fawkes BlackBoard Interface |
  Laser720Interface | Laser720Interface Fawkes BlackBoard Interface |
  LedInterface | LedInterface Fawkes BlackBoard Interface |
   SetIntensityMessage | SetIntensityMessage Fawkes BlackBoard Interface Message |
   TurnOffMessage | TurnOffMessage Fawkes BlackBoard Interface Message |
   TurnOnMessage | TurnOnMessage Fawkes BlackBoard Interface Message |
  LocalizerControlInterface | LocalizerControlInterface Fawkes BlackBoard Interface |
   ResetMessage | ResetMessage Fawkes BlackBoard Interface Message |
  MotorInterface | MotorInterface Fawkes BlackBoard Interface |
   AcquireControlMessage | AcquireControlMessage Fawkes BlackBoard Interface Message |
   DriveRPMMessage | DriveRPMMessage Fawkes BlackBoard Interface Message |
   GotoMessage | GotoMessage Fawkes BlackBoard Interface Message |
   LinTransRotMessage | LinTransRotMessage Fawkes BlackBoard Interface Message |
   OrbitMessage | OrbitMessage Fawkes BlackBoard Interface Message |
   ResetOdometryMessage | ResetOdometryMessage Fawkes BlackBoard Interface Message |
   RotMessage | RotMessage Fawkes BlackBoard Interface Message |
   SetMotorStateMessage | SetMotorStateMessage Fawkes BlackBoard Interface Message |
   TransMessage | TransMessage Fawkes BlackBoard Interface Message |
   TransRotMessage | TransRotMessage Fawkes BlackBoard Interface Message |
  NaoJointPositionInterface | NaoJointPositionInterface Fawkes BlackBoard Interface |
   MoveServoMessage | MoveServoMessage Fawkes BlackBoard Interface Message |
   MoveServosMessage | MoveServosMessage Fawkes BlackBoard Interface Message |
   SetServoMessage | SetServoMessage Fawkes BlackBoard Interface Message |
   SetServosMessage | SetServosMessage Fawkes BlackBoard Interface Message |
  NaoJointStiffnessInterface | NaoJointStiffnessInterface Fawkes BlackBoard Interface |
   SetBodyStiffnessMessage | SetBodyStiffnessMessage Fawkes BlackBoard Interface Message |
   SetStiffnessesMessage | SetStiffnessesMessage Fawkes BlackBoard Interface Message |
   SetStiffnessMessage | SetStiffnessMessage Fawkes BlackBoard Interface Message |
  NaoSensorInterface | NaoSensorInterface Fawkes BlackBoard Interface |
   EmitUltrasonicWaveMessage | EmitUltrasonicWaveMessage Fawkes BlackBoard Interface Message |
   StartUltrasonicMessage | StartUltrasonicMessage Fawkes BlackBoard Interface Message |
   StopUltrasonicMessage | StopUltrasonicMessage Fawkes BlackBoard Interface Message |
  NavigatorInterface | NavigatorInterface Fawkes BlackBoard Interface |
   CartesianGotoMessage | CartesianGotoMessage Fawkes BlackBoard Interface Message |
   ObstacleMessage | ObstacleMessage Fawkes BlackBoard Interface Message |
   PlaceGotoMessage | PlaceGotoMessage Fawkes BlackBoard Interface Message |
   PolarGotoMessage | PolarGotoMessage Fawkes BlackBoard Interface Message |
   ResetOdometryMessage | ResetOdometryMessage Fawkes BlackBoard Interface Message |
   SetEscapingMessage | SetEscapingMessage Fawkes BlackBoard Interface Message |
   SetMaxVelocityMessage | SetMaxVelocityMessage Fawkes BlackBoard Interface Message |
   SetSecurityDistanceMessage | SetSecurityDistanceMessage Fawkes BlackBoard Interface Message |
   StopMessage | StopMessage Fawkes BlackBoard Interface Message |
   TurnMessage | TurnMessage Fawkes BlackBoard Interface Message |
  ObjectPositionInterface | ObjectPositionInterface Fawkes BlackBoard Interface |
  OpenRaveInterface | OpenRaveInterface Fawkes BlackBoard Interface |
   AddObjectMessage | AddObjectMessage Fawkes BlackBoard Interface Message |
   AttachObjectMessage | AttachObjectMessage Fawkes BlackBoard Interface Message |
   DeleteObjectMessage | DeleteObjectMessage Fawkes BlackBoard Interface Message |
   MoveObjectMessage | MoveObjectMessage Fawkes BlackBoard Interface Message |
   ReleaseAllObjectsMessage | ReleaseAllObjectsMessage Fawkes BlackBoard Interface Message |
   ReleaseObjectMessage | ReleaseObjectMessage Fawkes BlackBoard Interface Message |
   RenameObjectMessage | RenameObjectMessage Fawkes BlackBoard Interface Message |
   RotateObjectMessage | RotateObjectMessage Fawkes BlackBoard Interface Message |
   RotateObjectQuatMessage | RotateObjectQuatMessage Fawkes BlackBoard Interface Message |
  PanTiltInterface | PanTiltInterface Fawkes BlackBoard Interface |
   CalibrateMessage | CalibrateMessage Fawkes BlackBoard Interface Message |
   FlushMessage | FlushMessage Fawkes BlackBoard Interface Message |
   GotoMessage | GotoMessage Fawkes BlackBoard Interface Message |
   ParkMessage | ParkMessage Fawkes BlackBoard Interface Message |
   SetEnabledMessage | SetEnabledMessage Fawkes BlackBoard Interface Message |
   SetMarginMessage | SetMarginMessage Fawkes BlackBoard Interface Message |
   SetVelocityMessage | SetVelocityMessage Fawkes BlackBoard Interface Message |
   StopMessage | StopMessage Fawkes BlackBoard Interface Message |
   TimedGotoMessage | TimedGotoMessage Fawkes BlackBoard Interface Message |
  Position2DTrackInterface | Position2DTrackInterface Fawkes BlackBoard Interface |
  Position3DInterface | Position3DInterface Fawkes BlackBoard Interface |
  RobotinoSensorInterface | RobotinoSensorInterface Fawkes BlackBoard Interface |
  Roomba500Interface | Roomba500Interface Fawkes BlackBoard Interface |
   DockMessage | DockMessage Fawkes BlackBoard Interface Message |
   DriveMessage | DriveMessage Fawkes BlackBoard Interface Message |
   DriveStraightMessage | DriveStraightMessage Fawkes BlackBoard Interface Message |
   SetModeMessage | SetModeMessage Fawkes BlackBoard Interface Message |
   SetMotorsMessage | SetMotorsMessage Fawkes BlackBoard Interface Message |
   StopMessage | StopMessage Fawkes BlackBoard Interface Message |
  SkillerDebugInterface | SkillerDebugInterface Fawkes BlackBoard Interface |
   SetGraphColoredMessage | SetGraphColoredMessage Fawkes BlackBoard Interface Message |
   SetGraphDirectionMessage | SetGraphDirectionMessage Fawkes BlackBoard Interface Message |
   SetGraphMessage | SetGraphMessage Fawkes BlackBoard Interface Message |
  SkillerInterface | SkillerInterface Fawkes BlackBoard Interface |
   AcquireControlMessage | AcquireControlMessage Fawkes BlackBoard Interface Message |
   ExecSkillContinuousMessage | ExecSkillContinuousMessage Fawkes BlackBoard Interface Message |
   ExecSkillMessage | ExecSkillMessage Fawkes BlackBoard Interface Message |
   ReleaseControlMessage | ReleaseControlMessage Fawkes BlackBoard Interface Message |
   RestartInterpreterMessage | RestartInterpreterMessage Fawkes BlackBoard Interface Message |
   StopExecMessage | StopExecMessage Fawkes BlackBoard Interface Message |
  SoccerPenaltyInterface | SoccerPenaltyInterface Fawkes BlackBoard Interface |
   SetPenaltyMessage | SetPenaltyMessage Fawkes BlackBoard Interface Message |
  SpeechRecognitionInterface | SpeechRecognitionInterface Fawkes BlackBoard Interface |
   ResetMessage | ResetMessage Fawkes BlackBoard Interface Message |
   SetEnabledMessage | SetEnabledMessage Fawkes BlackBoard Interface Message |
  SpeechSynthInterface | SpeechSynthInterface Fawkes BlackBoard Interface |
   SayMessage | SayMessage Fawkes BlackBoard Interface Message |
  SwitchInterface | SwitchInterface Fawkes BlackBoard Interface |
   DisableSwitchMessage | DisableSwitchMessage Fawkes BlackBoard Interface Message |
   EnableDurationMessage | EnableDurationMessage Fawkes BlackBoard Interface Message |
   EnableSwitchMessage | EnableSwitchMessage Fawkes BlackBoard Interface Message |
   SetMessage | SetMessage Fawkes BlackBoard Interface Message |
  TestInterface | TestInterface Fawkes BlackBoard Interface |
   CalculateMessage | CalculateMessage Fawkes BlackBoard Interface Message |
   SetTestIntMessage | SetTestIntMessage Fawkes BlackBoard Interface Message |
   SetTestStringMessage | SetTestStringMessage Fawkes BlackBoard Interface Message |
  TransformInterface | TransformInterface Fawkes BlackBoard Interface |
  VisualDisplay2DInterface | VisualDisplay2DInterface Fawkes BlackBoard Interface |
   AddCartCircleMessage | AddCartCircleMessage Fawkes BlackBoard Interface Message |
   AddCartLineMessage | AddCartLineMessage Fawkes BlackBoard Interface Message |
   AddCartRectMessage | AddCartRectMessage Fawkes BlackBoard Interface Message |
   AddCartTextMessage | AddCartTextMessage Fawkes BlackBoard Interface Message |
   DeleteAllMessage | DeleteAllMessage Fawkes BlackBoard Interface Message |
   DeleteObjectMessage | DeleteObjectMessage Fawkes BlackBoard Interface Message |
  CacheLogger | Logging Cache |
   CacheEntry | Cache entry struct |
  ComponentLogger | Component logger |
  ConsoleLogger | Interface for logging to stderr |
  UnknownLoggerTypeException | Unknown logger type exception |
  LoggerFactory | Logger factory |
  FileLogger | Interface for logging to a specified file |
  LibLogger | Library logger |
  Logger | Interface for logging |
  LoggerEmployer | Logger employer The LoggerEmployer shall pipe all log messages of the system to added loggers |
  MultiLogger | Log through multiple loggers |
  NetworkLogger | Interface for logging to network clients |
   network_logger_header_t | Network logging message header |
  NetworkLoggerMessageContent | Message sent over the network with a log message |
  SyslogLogger | Interface for logging to syslog |
  LuaContext | Lua C++ wrapper |
  LuaContextWatcher | Lua context watcher |
  LuaRuntimeException | Lua runtime exception |
  LuaErrorException | Lua error exception |
  LuaInterfaceImporter | Lua interface importer |
  LuaTriggerManager | Lua Trigger Manager |
  AvahiResolverHandler | Avahi resolver handler interface |
  AvahiThread | Avahi main thread |
  FawkesNetworkClientSendThread | Fawkes network client send thread |
  FawkesNetworkClientRecvThread | Fawkes network client receive thread |
  HandlerAlreadyRegisteredException | Client handler has already been registered |
  FawkesNetworkClient | Simple Fawkes network client |
  FawkesNetworkClientHandler | Message handler for FawkesNetworkClient |
  FawkesNetworkHandler | Network handler abstract base class |
  FawkesNetworkHub | Fawkes Network Hub |
  fawkes_message_header_t | Fawkes network message header |
  fawkes_message_t | Message as stored in local queues |
  fawkes_transfer_header_t | Fawkes transfer header |
  FawkesNetworkMessageTooBigException | The given message size exceeds the limit |
  FawkesNetworkMessage | Representation of a message that is sent over the network |
  FawkesNetworkMessageContent | Fawkes network message content |
  FawkesNetworkMessageQueue | A LockQueue of FawkesNetworkMessage to hold messages in inbound and outbound queues |
  FawkesNetworkManager | Fawkes Network Manager |
  FawkesNetworkServerClientSendThread | Sending thread for a Fawkes client connected to the server |
  FawkesNetworkServerClientThread | Fawkes Network Client Thread for server |
  FawkesNetworkServerThread | Fawkes Network Thread |
  FawkesNetworkTransceiver | Fawkes Network Transceiver |
  ServiceBrowseHandler | Interface for class that process browse results |
  DummyServiceBrowser | Dummy Service browser |
  DummyServicePublisher | Dummy service publisher interface |
  NetworkService | Representation of a service announced or found via service discovery (i.e |
  ServiceBrowser | Service browser |
  ServicePublisher | Service publisher interface |
  DatagramSocket | Datagram socket |
  BroadcastDatagramSocket | Broadcast datagram socket |
  MulticastDatagramSocket | Multicast datagram socket |
  SocketException | Socket exception |
  Socket | Socket base class |
  StreamSocket | TCP stream socket over IP |
  NetworkAcceptorThread | Network Acceptor Thread |
  dynamic_list_t | Dynamic list type |
  DynamicBuffer | Dynamically growing buffer |
  ConnectionDiedException | Thrown if the connection died during an operation |
  NetworkIncomingConnectionHandler | Interface for handling incoming connections |
  NetworkNameResolver | Network name and address resolver |
  NetworkNameResolverThread | Worker thread for NetworkNameResolver |
  StringContent | Content for a variable length string |
  MessageDecryptionException | Message decryption failed |
  WorldInfoMessageDecryptor | WorldInfo message decryptor |
  MessageEncryptionException | Message encryption failed |
  WorldInfoMessageEncryptor | WorldInfo message encryptor |
  WorldInfoHandler | World info handler |
  worldinfo_message_header_t | Per-message header |
  worldinfo_header_t | World info header |
  worldinfo_pose_message_t | Robot pose message |
  worldinfo_velocity_message_t | Robot velocity message |
  worldinfo_relballpos_message_t | Relative ball position message |
  worldinfo_globballpos_message_t | Global ball position message |
  worldinfo_relballvelo_message_t | Relative ball velocity message |
  worldinfo_globballvelo_message_t | Global ball velocity message |
  worldinfo_opppose_message_t | Opponent message |
  worldinfo_oppdisappeared_message_t | Opponent disappeared |
  worldinfo_fat_message_t | Fat worldinfo message |
  worldinfo_gamestate_message_t | Game state message |
  worldinfo_penalty_message_t | Penalty message |
  WorldInfoException | Thrown on critical errors in world info handling |
  WorldInfoTransceiver | Class to send and receive world information |
  PluginManagerListener | PluginManager listener |
  PluginLoadException | This exception is thrown if the requested plugin could not be loaded |
  PluginUnloadException | This exception is thrown if the requested plugin could not be unloaded |
  PluginLoader | This class manages plugins |
  PluginManager | Fawkes Plugin Manager |
  PluginNetworkHandler | Fawkes Plugin Network Handler |
  PluginListMessage | Plugin list message |
  plugin_load_msg_t | Load plugin message |
  plugin_unload_msg_t | Unload plugin message |
  plugin_loaded_msg_t | Plugin loaded message |
  plugin_load_failed_msg_t | Plugin load failed |
  plugin_unload_failed_msg_t | Plugin unload failed |
  plugin_unloaded_msg_t | Plugin unloaded message |
  plugin_list_msg_t | Plugin list message |
  DependencyViolationException | Dependency violation exception |
  OneToManyDependency | One-to-Many dependency constraint |
  UniquenessViolationException | Uniqueness violation exception |
  UniquenessConstraint | Uniqueness constraint |
  RCSoftMapGraph | Read RCSoft map graphs |
  RCSoftMapNode | RCSoft map node representation |
  IPCMessageQueue | IPC message queue |
   MessageStruct | This is the struct of the messages that has to be fed to send and receive methods |
  MessageTooBigException | Message did not fit into buffer |
  SemInvalidException | Semaphore or semaphore set invalid |
  SemCannotLockException | Cannot lock semaphore |
  SemCannotUnlockException | Cannot unlock semaphore |
  SemCannotSetValException | Cannot set value on semaphore |
  SemaphoreSet | IPC semaphore set |
  SharedMemoryHeader | Interface for shared memory header |
  SharedMemory | Shared memory segment |
   SharedMemory_header_t | General header |
   SharedMemoryIterator | Shared Memory iterator |
  ShmCouldNotAttachException | Could not attach to shared memory segment |
  ShmNoHeaderException | No shared memory header set before attach() |
  ShmInconsistentSegmentSizeException | Memory size does not match |
  ShmDoesNotExistException | Shared memory segment does not exist |
  ShmCouldNotAttachAddrDepException | The shared memory is set adress-dependend but could not be opened at the appropriate address |
  ShmAddrOutOfBoundsException | The address points out of the shared memory |
  ShmPtrOutOfBoundsException | The pointer does not point inside the shared memory |
  SharedMemoryLister | Format list output for shared memory segments |
  SharedMemoryRegistry | Shared memory registry |
   SharedMemID | Shared memory identifier |
  KalmanFilter1D | One-dimensional Kalman filter implementation for single-precision floats |
  BinomialCoefficient | Contains method to compute the binomial coefficient |
  Interpolator | Value interpolator |
  LinearInterpolator | Linear value interpolator |
  SinusoidalInterpolator | Sinusoidal value interpolator |
  point_t | Point with cartesian coordinates as unsigned integers |
  cart_coord_2d_t | Cartesian coordinates (2D) |
  cart_coord_3d_t | Cartesian coordinates (3D) |
  polar_coord_2d_t | Polar coordinates |
  extent_2d_t | Rectangular extent with unsigne integers |
  rectangle_t | Rectangle (unsigned integers) |
  field_pos_t | Position on the field |
  field_line_struct | Describes a field line |
  arc_struct | Defines an arc (or circle) |
  point_6D_struct | Defines a point with 6-degrees of freedom |
  MemAutoFree | Automatically free memory on destruction |
  StringEquality | String equality checker |
  StringLess | String less than test |
  StringConversions | Utility class that holds string methods |
  AStar | This is an implementation of the A* search algorithm |
  AStarState | This is the abstract(!) class for an A* State |
  UnknownArgumentException | Thrown if unknown argument was supplied |
  MissingArgumentException | Thrown if required argument was missing |
  ArgumentParser | Parse command line arguments |
  ModuleOpenException | Opening a module failed |
  Module | Dynamic module loader for Linux, FreeBSD, and MacOS X |
  ModuleManager | Dynamic module manager |
  FamListener | File Alteration Monitor Listener |
  FileAlterationMonitor | Monitors files for changes |
  FamThread | FileAlterationMonitor thread wrapper |
  UnableToOpenFileException | Opening a file failed for some reason |
  File | File utility methods |
  HostInfo | Host information |
  PathParser | Path parser |
  SignalHandler | Interface for signal handling |
  SignalManager | System signal manager |
  Clock | This is supposed to be the central clock in Fawkes |
  SimulatorTimeSource | Simulation time source |
  Time | A class for handling time |
  TimeSource | TimeSource interface |
  TimeTracker | Time tracking utility |
  TimeWait | Time wait utility |
  Watch | This is a stop-watch |
  WebErrorPageReply | Static error page reply |
  DynamicFileWebReply | Dynamic raw file transfer reply |
  TracWikiHeadingFormatter | Translate Trac wiki heading syntax to HTML |
  WebNavManager | Manage visible navigation entries |
  WebPageFooterGenerator | Interface for HTML footer generator |
  WebPageHeaderGenerator | Interface for HTML header generator |
  WebPageReply | Basic page reply |
  WebRedirectReply | Redirect reply for webview |
  WebReply | Basic web reply |
  DynamicWebReply | Dynamic web reply |
  StaticWebReply | Static web reply |
  WebRequestDispatcher | Web request dispatcher |
  WebRequestProcessor | Abstract web request processor |
  WebServer | Encapsulation of the libmicrohttpd webserver |
  WebUrlManager | Manage URL mappings |
  WebUserVerifier | Interface for user verification |
  WorldInfoDataContainer | Data container to store and exchange worldinfo data |
   GameState | Container struct for momentary game state infos |
  CLIPSAspect | Thread aspect to get access to a CLIPS environment |
  CLIPSAspectIniFin | CLIPSAspect initializer/finalizer |
  KatanaController | Abstract class for a Neuronics Katana controller |
  KatanaControllerKni | Controller class for a Neuronics Katana, using libkni to interact with the real Katana arm |
  KatanaControllerOpenrave | Controller class for a Neuronics Katana, using libkni to interact with the real Katana arm |
  KatanaNoSolutionException | No joint configuration for desired target found |
  KatanaOutOfRangeException | At least one motor is out of range |
  KatanaMotorCrashedException | At least one motor crashed |
  KatanaUnsupportedException | Unsupported command |
  NaoQiAspect | Thread aspect to get access to NaoQi broker |
  NaoQiAspectIniFin | NaoQiAspect initializer/finalizer |
  OpenNiAspect | Thread aspect to get access to the OpenNI context |
  OpenNiAspectIniFin | OpenNiAspect initializer/finalizer |
  OpenRaveAspect | Thread aspect create, update, and graph round-robin databases (RRD) |
  OpenRaveConnector | Interface for a OpenRave connection creator |
  OpenRaveAspectIniFin | OpenRaveAspect initializer/finalizer |
  OpenRaveEnvironment | OpenRaveEnvironment class |
  OpenRaveManipulator | Class containing information about all manipulator motors |
  OpenRaveManipulatorKatana6M180 | Class containing information about all katana6M180 motors |
  OpenRaveManipulatorNeuronicsKatana | Class containing information about all neuronics-katana motors |
  OpenRaveRobot | OpenRAVE Robot class |
  motor_t | Struct containing angle of current motor, its number in OpenRAVE and corresponding motor number of real devices |
  target_t | Struct containing information about the current target |
  ROSAspect | Thread aspect to get access to a ROS node handle |
  ROSAspectIniFin | ROSAspect initializer/finalizer |
  RRDAspect | Thread aspect create, update, and graph round-robin databases (RRD) |
  RRDDataSource | Class to represent a RRD data source |
  RRDArchive | RRD Archive description |
  RRDDefinition | RRD Definition |
  RRDGraphDataDefinition | Represent data definition in graph arguments |
  RRDGraphElement | Interface for graph elements |
  RRDGraphGPrint | Print string inside graph |
  RRDGraphLine | Print graph line |
  RRDGraphArea | Print graph area |
  RRDGraphDefinition | Class representing a graph definition |
  RRDAspectIniFin | RRDAspect initializer/finalizer |
  RRDManager | Interface for a RRD connection creator |
 firevision | |
  Bumblebee2Camera | Bumblebee2 camera |
  CameraNotOpenedException | Camera not opened exception |
  CameraNotStartedException | Camera not started exception |
  CaptureException | Capturing a frame failed |
  UnknownCameraTypeException | Unknown camera type exception |
  UnknownCameraException | Unknown camera exception |
  UnknownCameraControlTypeException | Unknown camera control exception |
  Camera | Camera interface for image aquiring devices in FireVision |
  CameraControlColor | Camera color control interface |
  CameraControl | Camera control interface base class |
  DummyCameraControl | Plain dummy control |
  CameraControlEffect | Camera effect control interface |
  CameraControlFactory | Camera control factory |
  CameraControlFocus | Camera focus control interface |
  CameraControlImage | Camera image control interface |
  CameraControlPanTilt | Camera pan/tilt control interface |
  SonyEviD100PControl | Sony Evi D100P pan/tilt control |
  CameraControlSource | Camera source control interface |
  ViscaControlException | Visca exception |
  ViscaControlInquiryRunningException | Visca inquire running exception |
  ViscaControl | Visca control protocol implementation over a serial line |
  CameraControlZoom | Camera zoom control interface |
  CameraFactory | Camera factory |
  FileLoader | Load images from files |
  FirewireCamera | Firewire camera |
  FvFreenectDevice | Implementation of the FreenectDevice interface of the driver |
  KinectCamera | Access the Microsoft Kinect camera using the freenect driver |
  LeutronCamera | Cameras accessed through Leutron framegrabber |
  NaoCamera | Video4Linux 2 camera with Nao-specific extensions |
  NetworkCamera | Network camera |
  avt_autofnc_aoi_t | White balance settings data structure |
  avt_af_area_position_t | Datastructure for the position of the autofunction AOI |
  avt_af_area_size_t | Datastructure for the size of the autofunction AOI |
  avt_version_info1_t | Datastructure for version information of the uC |
  avt_version_info3_t | Datastructure for version information of the FGPA |
  PikeCamera | Pike camera |
  SharedMemoryCamera | Shared memory camera |
  SwissRangerCamera | SwissRanger camera |
  V4LCamera | General Video4Linux camera implementation |
  V4L1Camera | Video4Linux 1 camera implementation |
  V4L2Camera | Video4Linux 2 camera access implementation |
  BorderShrinker | Border shrinker |
  Classifier | Classifier to extract regions of interest |
  FacesClassifier | Faces classifier |
  GradientClassifier | Gradient classifier |
  MultiColorClassifier | Simple multi-color classifier |
  Qualifier | Abstract Qualifier for a single pixel |
  LumaQualifier | LumaQualifier for a single pixel |
  SkyblueQualifier | SkyblueQualifier for a single pixel |
  YellowQualifier | YellowQualifier for a single pixel |
  Shrinker | Shrinker class to shrink ROIs |
  SiftClassifier | SIFT classifier |
  SiftppClassifier | SIFTPP classifier |
   Feature | Siftpp Feature struct |
  SimpleColorClassifier | Simple classifier |
  SquareShrinker | Square shrinker |
  SurfClassifier | SURF classifier |
  FilterCompare | Comparison filter |
  FilterDifference | Calculates the difference of two images |
  Filter | Filter interface |
  FilterGauss | Gaussian filter |
  FilterHipass | Hipass filter |
  FilterHSearch | Search horizontally for a color change |
  FilterHVSearch | Horizontal/vertical search filter |
  FilterInvert | Inversion filter |
  FilterLaplace | Laplacian filter |
  FilterMax | Maximum filter |
  FilterMedian | Median filter |
  FilterMin | Minimum filter |
  FilterClosing | Morphological closing |
  FilterDilation | Morphological dilation |
  FilterErosion | Morphological erosion |
  FilterGeodesicDilation | Morphological geodesic dilation |
  FilterGeodesicErosion | Morphological geodesic erosion |
  MorphologicalFilter | Morphological filter interface |
  FilterOpening | Morphological opening |
  SEGenerator | Basic generators for structuring elements for morphological filters |
  FilterTophatClosing | Morphological tophat closing |
  FilterNothing | A filter that does.. |
  FilterOr | Or filter |
  FilterRectify | Rectify image |
  FilterROIDraw | ROI Drawing filter |
  FilterSegment | Segmentation filter |
  FilterColorSegmentation | Segmentation filter |
  FilterScanlineSegmentation | Segmentation filter |
  FilterShapeRemover | Remove shapes from an image |
  FilterSharpen | Sharpen filter |
  FilterSobel | Sobel filter |
  FilterSum | Sum filter |
  FilterThreshold | Threshold filter |
  FilterUnwarp | Create unwarped image with given mirror model |
  Calibration | A Calibration matrix for a finite camera |
  CCDCalibration | A Calibration matrix for a ccd camera |
  CCDCam | A class for a ccd camera model |
  AboveHorizonException | The point that should be calculated lies above the horizon |
  ProjectiveCam | Abstract class for projective cameras |
  ColorModel | Color model interface |
  ColorModelLookupTable | Color model based on a lookup table |
  ColorModelThresholds | Really simple thresholds-based model with some hard-coded thresholds |
  GlobalPositionModel | Global Position Model Interface |
  GlobalFromRelativePos | Calculate global ball position based on a relative position model |
  OmniGlobal | Omni vision global position model |
  Bulb | Bulb mirror lookup table |
   bulb_file_header_t | Bulb file header |
  MirrorCalibTool | This class encapsulates the routines necessary for interactive mirror calibration |
   CartesianImage | Wraps an image so that access to (0, 0) is mapped to the middle of the image and so on |
   CartesianPoint | A cartesian point is a 2d point which can have negative X and Y coords |
   Hole | A hole is a sequence of pixels between two lines |
   Image | A container for a YUV-buffer etc |
   PixelPoint | A pixel point is a 2d point with positive X and Y coords |
   Point | Abstract Point class |
   StepResult | The result of a step contains a YUV buffer |
  MirrorModel | Mirror model interface |
  BackProjectionPositionModel | This model uses a ProjectiveCam to back project points in the image to the world by the ground plane assumption |
  BallTrigoRelativePos | Relative ball position model for pan/tilt camera |
  BoxRelative | Relative (beer) box position model |
  FrontBallRelativePos | Relative ball position model for front vision |
  OmniRelative | Omni vision relative position model |
  RelativePositionModel | Relative Position Model Interface |
  ScanlineBeams | Raytraced beams scanline model |
  CornerHorizon | Cut of arbitrary scanline models at an artificial horizon |
  ScanlineGrid | Scanline Grid |
  ScanlineLineGrid | Grid of scan lines |
  ScanlineRadial | Radial scanlines |
  ScanlineModel | Scanline model interface |
  ScanlineStar | Star-like arranged scanline points |
  FittedCircle | FittedCircle accumulator |
  FitAccum | FIT Accumulator |
  RhtAccNode | Hough-Transform accumulator node |
  RhtRNode | Hough-Transform accumulator node |
  RhtYNode | Hough-Transform accumulator node |
  RhtXNode | Hough-Transform accumulator node |
  RhtAccumulator | Hough-Transform accumulator |
  Circle | Circle shape |
  HtLinesModel | Hough-Transform line matcher |
  LineShape | Line shape |
  RcdCircleModel | RCD circle model from the following literature An Efficient Randomized Algorithm for Detecting Circles |
  RhtCircleModel | Randomized Hough-Transform circle model |
  RhtLinesModel | Randomized Hough-Transform line model |
  Shape | Shape interface |
  ShapeModel | Shape model interface |
  VelocityGlobalFromRelative | Global velocity from relative velocities |
  VelocityFromGlobal | Velocity from global positions |
  vel_postime_t | Position/time tuple |
  vel_veltime_t | Velocity/time tuple |
  VelocityFromRelative | Calculate velocity from relative positions |
  VelocityModel | Velocity model interface |
  StereoProcessor | Stereo processor interface |
  TriclopsStereoProcessor | Stereo processing using PGR Triclops SDK |
  IplImageAdapter | Adapter for OpenCV IplImages |
  ROI | Region of interest |
  center_in_roi_t | Center in ROI |
  pcl_point_t | Structure defining a point in a CARTESIAN_3D_FLOAT buffer |
  pcl_point_xyzrgb_t | Structure defining a point in a CARTESIAN_3D_FLOAT_RGB buffer |
  VisionMaster | Vision Master |
  CameraTracker | Camera Tracker |
  ColorObjectMap | Color mapping class |
  RGB_t | Structure defining an RGB pixel (in R-G-B byte ordering) |
  BGR_t | Structure defining an RGB pixel (in B-G-R byte ordering) |
  YUV_t_struct | YUV pixel |
  ZSlice | "slice" is a row of consecutive pixels (horizontal) |
  ZRegion | Region is a stack of slices, together with the y-position of the slice at the top |
  Zauberstab | Zaubertab selection utility |
  BayesColormapGenerator | Colormap Generator using Bayes method |
  BayesHistosToLut | LUT generation by using Bayesian method on histograms |
  cmfile_header_t | Block header for a Colormap header block in a ColormapFile |
  ColormapFile | Colormap file |
   ColormapBlockVector | Vector of colormap blocks |
  ColormapFileBlock | FireVision data file block for colormap files |
  cmfile_yuvblock_header_t | Block header for a YUV block in a ColormapFile |
  ColormapFileYuvBlock | YUV block for colormap file |
  Colormap | Colormap interface |
  ColormapGenerator | Interface for colormap generators |
  YuvColormap | YUV Colormap |
  ImageCompressor | Image compressor interface |
  ImageDecompressor | Image de-compressor interface |
  JpegImageCompressor | Jpeg image compressor |
  JpegImageDecompressor | Decompressor for JPEG images |
  Drawer | Draw to an image |
  Field | This class is used to describe a soccer field |
  FieldDrawer | This class is used to draw a soccer field |
  FieldLines | This class acts as a container for lines on a soccer field |
  FieldLines6x4 | This class implements the 6 by 4 meter SPL field according to the 2008 roules |
  FieldLinesCityTower | This class implements the test field in Graz, Austria at the CityTower |
  FieldLinesCityTowerSeminar | This class implements the test field in Graz, Austria at the CityTower |
  MonoDrawer | Draw to a monochrome image |
  _fvff_header_t | Header for a FireVision file format file |
  _fvff_block_header_t | Block header |
  FireVisionDataFile | FireVision File Format for data files |
  FireVisionDataFileBlock | FireVision File Format data block |
  InconsistentImageException | Throw if an inconsistent image was found |
  InconsistentLUTException | Throw if an inconsistent LUT was found |
  SharedMemoryImageBuffer_header_t | Shared memory header struct for FireVision images |
  SharedMemoryImageBufferHeader | Shared memory image buffer header |
  SharedMemoryImageBufferLister | Shared memory image buffer lister |
  SharedMemoryImageBuffer | Shared memory image buffer |
  SharedMemoryLookupTable_header_t | Shared memory lookup table header struct |
  SharedMemoryLookupTableHeader | Shared memory lookup table header |
  SharedMemoryLookupTableLister | Shared memory lookup table lister |
  SharedMemoryLookupTable | Shared memory lookup table |
  FUSE_header_t | General packet header |
  FUSE_message_t | FUSE message |
  FUSE_greeting_message_t | Version packet, bi-directional |
  FUSE_lut_message_header_t | Lookup table packet header |
  FUSE_image_message_header_t | Image packet header |
  FUSE_imagereq_message_t | Image request message |
  FUSE_imagedesc_message_t | Image description message |
  FUSE_lutdesc_message_t | LUT description message |
  FUSE_imageinfo_t | Image info message |
  FUSE_lutinfo_t | LUT info message |
  FUSE_imagelist_message_t | Image list message |
  FUSE_lutlist_message_t | LUT list message |
  FuseClient | FUSE client |
  FuseClientHandler | FUSE client handler |
  FuseImageContent | FUSE image content |
  FuseImageListContent | FUSE image list content |
  FuseLutContent | FUSE lookup table content |
  FuseLutListContent | FUSE lookup table list content |
  FuseNetworkMessage | FUSE Network Message |
  FuseMessageContent | FUSE message content |
  FuseNetworkMessageQueue | A LockQueue of FuseNetworkMessage to hold messages in inbound and outbound queues |
  FuseServer | FireVision FUSE protocol server |
  FuseServerClientThread | FUSE Server Client Thread |
  FuseNetworkTransceiver | FUSE Network Transceiver |
  FvRawReader | FvRaw image reader implementation |
  JpegReader | JPEG file reader |
  PNGReader | PNG file reader |
  PNMReader | PNM file reader |
  Reader | Image reader interface |
  RectificationInfoFile | Rectification Info File |
   RectInfoBlockVector | Vector that is used for maintaining the rectification info blocks |
  _rectinfo_header_t | Header for a rectification information file (rectinfo) |
  _rectinfo_block_header_t | The per-image rectification info block header |
  _rectinfo_lut_16x16_block_header_t | Block header for rectification LUTs wit 16-bit values |
  _rectinfo_lut_16x16_entry_t | Data type used to build a rectification LUT |
  RectificationInfoBlock | Rectification info block |
  RectificationLutInfoBlock | Recitification Lookup Table Block |
  LossyScaler | Lossy image scaler |
  Scaler | Image scaler interface |
  Histogram | Histogram |
  _histogram_block_header_t | Header for a histogram block |
  HistogramBlock | This class defines a file block for histograms |
  HistogramFile | A fileformat for histograms |
  ImageDiff | Image difference checker |
  CameraArgumentParser | Camera argument parser |
  CompressedImageWriter | Writer for arbitrarily compressed images |
  FvRawWriter | FvRaw Writer implementation |
   FvRawHeader | FvRaw image file header |
  JpegWriter | JPEG file writer |
  PNGWriter | PNG file writer |
  PNMWriter | PNM file writer |
  SeqWriter | Writes a sequence of images to disk |
  Writer | Interface to write images |
  FuseImageListWidget | This widget displays all available Fuse images in a tree view |
  ImageDisplay | Simple image display |
  ImageWidget | This class is an image container to display fawkes cameras (or image buffers) inside a Gtk::Container |
  SDLKeeper | SDL Reference keeper |
 graspplanning | |
  GraspPlanner | Class to plan a grasp for a given robot and target |
 pcl | |
  PointCloud | |
 rec | |
  sharedmemory | |
   SharedMemory | |
 AgentControlThread | This thread controls the agent thread by sending signals |
 amcl_hyp_t | Pose hypothesis |
 AmclPlugin | Adaptive Monte Carlo Localization plugin |
 AmclThread | Thread to perform Adaptive Monte Carlo Localization |
 BallPosLogPlugin | Simple ball position logger plugin |
 BallPosLogThread | Main thread of ball position logger plugin |
 BatteryMonitor | A battery monitor |
 BatteryMonitorTreeView | A treeview that retrieves battery data from the robots over remote blackboard connections and displays those |
  BatteryRecord | Column record class for the battery monitor treeview |
 bblog_entry_header | BBLogger entry header |
 bblog_file_header | BBLogger file header definition |
 BBLogFile | Class to easily access bblogger log files |
 BBLoggerThread | BlackBoard logger thread |
 BBLogReplayBlockedTimingThread | BlackBoard log replay blocked timing thread |
 BBLogReplayThread | BlackBoard log Replay thread |
 BeepController | Simple speaker beep controller |
 BlackBoardLoggerPlugin | BlackBoard logger plugin |
 BlackBoardLogReplayPlugin | BlackBoard log replay plugin |
 BlackBoardSynchronizationPlugin | BlackBoard synchronization plugin |
 BlackBoardSynchronizationThread | Thread to synchronize two BlackBoards |
 CLIPSPlugin | Plugin to access CLIPS from Fawkes |
 CLIPSThread | CLIPS environment thread |
 ColormapViewerWidget | Select a layer from a colormap and render it to a Gtk::Image |
 ColorTrainWidget | This widget implements the complete color training process |
 ConfigAddDialog | Dialog to add a config entry |
 ConfigChangeWatcherTool | Tool to watch and output config changes |
 ConfigEditDialog | Dialog to edit a config value |
 ConfigEditorPlugin | Base class for plugins for the Fawkes config editor |
 ConfigRemoveDialog | Dialog to remove a config entry |
 ConfigTreeView | Treeview widget for displaying/editing config entries |
  ConfigRecord | Column record class for the config TreeView |
 CppInterfaceGenerator | Generator that transforms input from the InterfaceParser into valid C++ classes |
 DirectedPerceptionPTU | DirectedPerception PTU implementation |
 EclipseAgentThread | This thread creates an ECLiPSe context in which the Readylog interpreter and the program are loaded |
 ExampleBlackBoardThread | Simple demonstration for a thread using the BlackBoard |
 ExampleFinalizeNettlerThread | Thread of example plugin |
 ExampleNetworkThread | Network thread of example plugin |
 ExamplePlugin | Simple example plugin |
 ExamplePluginClientNetworkReceiver | Example Plugin network ping tool Small class that waits for a reply of the example plugin after a short network message was sent |
 ExampleThread | Thread of example plugin |
 FawkesBeepDaemon | Fawkes beep daemon |
 FawkesConfigEditor | Graphical configuration editor |
 FestivalPlugin | Festival plugin for Fawkes |
 FestivalSynthThread | Festival Synthesis Thread |
 FieldView | Drawing widget that draws an (MSL-) soccer field with robots, opponents, and balls |
 Firestation | Control GUI for vision related stuff |
 FireVisionNetworkTool | FireVision Network Tool |
 FlitePlugin | Flite plugin for Fawkes |
 FliteSynthThread | Flite Synthesis Thread |
 FountainThread | Fountain main thread |
 FuseTransferWidget | This class implements the logic for a GUI that allows to transfer LUTs via FUSE |
 FuseViewerGtkWindow | Fawkes network camera viewer |
 FvAcquisitionThread | FireVision base application acquisition thread |
 FvAqtVisionThreads | Aquisition-dependant threads |
 FvBasePlugin | FireVision Base Plugin This is the FireVision base plugin |
 FvBaseThread | FireVision base thread |
 FvFountainPlugin | FireVision Fountain Plugin |
 FvRetrieverPlugin | FireVision Retriever Plugin |
 FvRetrieverThread | FireVision retriever thread |
 FvSrSavePipelineThread | SrSave vision image processing pipeline |
 FvSrSavePlugin | SwissRanger Save Plugin |
 HokuyoUrgAcquisitionThread | Laser acqusition thread for Hokuyo URG laser range finders |
 HokuyoUrgGbxAcquisitionThread | Laser acqusition thread for Hokuyo URG laser range finders |
 HoughTransform | Hough Transformation for N-dimensional representations |
 InterfaceConstant | Interface generator internal representation of a constant as parsed from the XML template file |
 InterfaceDataTypeChecker | Type checker for interface types |
 InterfaceDigest | Interface digest generator |
 InterfaceEnumConstant | Interface generator internal representation of a enum constant as parsed from the XML template file |
  EnumItem | Enumeration item |
 InterfaceField | Interface generator internal representation of a field as parsed from the XML template file |
 InterfaceGeneratorAmbiguousNameException | Thrown if name is ambiguous |
 InterfaceGeneratorInvalidAttributeException | Thrown if illegal attribute is supplied |
 InterfaceGeneratorInvalidContentException | Thrown if document contains illegal content |
 InterfaceGeneratorInvalidDocumentException | Thrown if document was invalid |
 InterfaceGeneratorInvalidFlagException | Thrown if illegal flag is supplied |
 InterfaceGeneratorInvalidTypeException | Thrown if illegal type is supplied |
 InterfaceGeneratorInvalidValueException | Thrown if illegal value is supplied |
 InterfaceGeneratorMissingAttributeException | Thrown if required attribute is missing supplied |
 InterfaceMessage | Interface generator internal representation of a message as parsed from the XML template file |
 InterfaceParser | Parser used to get information out of interface template |
 InterfacePseudoMap | Interface generator internal representation of a pseudo map as parsed from the XML template file |
 JoystickAcquisitionThread | Joystick acqusition thread for Linux joystick API |
 JoystickActThread | Joystick force feedback actuation thread |
  MessageProcessor | Process incoming messages |
 JoystickBlackBoardActListener | Wake actuator thread on incomin messages |
 JoystickBlackBoardHandler | Handler class for joystick data |
 JoystickBlackBoardLogger | Log joystick data gathered via RemoteBlackBoard to console |
 JoystickForceFeedback | Cause force feedback on a joystick |
 JoystickPlugin | Joystick plugin for Fawkes |
 JoystickQuitHandler | Simple signal handler for ffjoystick |
 JoystickRemoteBlackBoardPoster | Glue to post new data to a RemoteBlackBoard |
 JoystickSensorThread | Joystick sensor thread |
 KatanaActThread | Katana act thread |
 KatanaCalibrationThread | Katana calibration thread |
 KatanaGotoOpenRaveThread | Class KatanaGotoOpenRaveThread |
 KatanaGotoThread | Katana linear goto thread |
 KatanaGripperThread | Katana gripper thread |
 KatanaMotionThread | Katana motion thread base class |
 KatanaMotorControlThread | Katana motor control thread |
 KatanaPlugin | Plugin to drive Neuronics' Katana arm with Fawkes |
 KatanaSensorAcquisitionThread | Katana sensor acquisition thread |
 KatanaSensorThread | Katana sensor thread |
 LaseEdlAcquisitionThread | Laser acqusition thread for Lase EDL L A laser scanner |
 Laser720to360DataFilter | Downsample filter from 720 to 360 values |
 LaserAcquisitionThread | Laser acqusition thread |
 LaserCircleSectorDataFilter | Erase beams outside specified circle sector |
 LaserDataFilter | Laser data filter |
  Buffer | Laser data buffer |
 LaserDataFilterCascade | Cascade of several laser filters to one |
 LaserDeadSpotCalibrator | Calibrator for dead ranges |
 LaserDeadSpotsDataFilter | Erase dead spots (i.e |
 LaserDrawingArea | Laser drawing area |
 LaserFilterPlugin | Laser filter plugin for Fawkes |
 LaserFilterThread | Laser filter thread |
 LaserGuiGtkWindow | Laser GUI window for Gtkmm |
 LaserGuiHildonWindow | Laser GUI window for Hildon |
 LaserHoughTransformPlugin | Laser Hough Transform plugin for Fawkes |
 LaserHtSensorProcThread | Laser Hough Transform sensor processing thread |
 LaserMaxCircleDataFilter | Cut of laser data at max distance |
 LaserMinCircleDataFilter | Erase beams below a certain minimum distance distance |
 LaserMinMergeDataFilter | Merge multiple laser data arrays into one |
 LaserPlugin | Laser plugin for Fawkes |
 LaserPointCloudPlugin | Plugin to convert laser data to point clouds |
 LaserPointCloudThread | Thread to exchange transforms between Fawkes and ROS |
 LaserProjectionDataFilter | Projects one laser into another laser's plane |
 LaserReverseAngleDataFilter | Reverse the angle of beams |
 LaserSensorThread | Laser sensor thread |
 LuaAgentContinuousExecutionThread | LuaAgent Periodic Execution Thread |
 LuaAgentPeriodicExecutionThread | LuaAgent Periodic Execution Thread |
 LuaAgentPlugin | LuaAgent Plugin |
 MapLaserGenPlugin | Laser data from map generator plugin |
 MapLaserGenThread | Generate laser data from map and position |
 MidsizeRefBoxRepeater | Mid-size league refbox repeater |
 MiniImageProducer | Mini image producer |
 Msl2008RefBoxRepeater | Mid-size league refbox repeater |
 Msl2010RefBoxProcessor | Mid-size league refbox repeater |
 Msl2010RefBoxRepeater | Mid-size league refbox repeater |
 NaoFawkesModule | Nao Fawkes Module |
 NaoGuiGtkWindow | Nao GUI main window |
 NaoQiBrokerThread | NaoQi Broker Thread |
 NaoQiButtonPlugin | Plugin to provide NaoQi buttons to Fawkes |
 NaoQiButtonThread | Thread to provide buttons to Fawkes |
 NaoQiDCMThread | Thread to provide DCM to Fawkes |
  HighFreqThread | Thread to write data at full DCM frequency |
 NaoQiLedPlugin | Plugin to provide NaoQi LEDs to Fawkes |
 NaoQiLedThread | Thread to synchronize with LEDs |
 NaoQiMotionKickTask | NaoQi kick task |
 NaoQiMotionPlugin | Plugin to provide NaoQi motion to Fawkes |
 NaoQiMotionStandupTask | NaoQi standup task |
 NaoQiMotionThread | Thread to provide NaoQi motions to Fawkes |
 NaoQiPlugin | Plugin to access NaoQi from Fawkes |
 NaoQiSpeechSynthPlugin | Plugin to provide NaoQi speech synthesis to Fawkes |
 NaoQiSpeechSynthThread | Thread to provide NaoQi motions to Fawkes |
 NaoStiffnessConfigDialog | Config dialog of the config editor plugin for the nao joint stiffnesses |
  nao_stiffnesses | < joint stiffness values |
 NaoStiffnessConfigPlugin | Config editor plugin for the Nao joint stiffness values |
 NetLogGuiGtkWindow | NetLog GUI main window |
 OpenNiContextThread | OpenNI Context Thread |
 OpenNiDataPlugin | Plugin provide raw OpenNI data to Fawkes plugins |
 OpenNiDepthThread | OpenNI Depth Provider Thread |
 OpenNiHandTrackerPlugin | Plugin to track hands using OpenNI |
 OpenNiHandTrackerThread | OpenNI Hand Tracker Thread |
 OpenNiImageThread | OpenNI Image Provider Thread |
 OpenNiPclOnlyPlugin | Create PCL from pointcloud buffer |
 OpenNiPclOnlyThread | OpenNI Point Cloud Provider Thread |
 OpenNiPlugin | Plugin to access OpenNI from Fawkes |
 OpenNiPointCloudThread | OpenNI Point Cloud Provider Thread |
 OpenNiUserTrackerPlugin | Plugin to track users using OpenNI |
 OpenNiUserTrackerThread | OpenNI User Tracker Thread |
 OpenRaveMessageHandlerThread | OpenRAVE Thread |
 OpenRavePlugin | OpenRAVE Connector plugin |
 OpenRaveThread | OpenRAVE Thread |
 PanTiltActThread | Pan/tilt act thread |
 PanTiltDirectedPerceptionThread | PanTilt act thread for PTUs from DirectedPerception employing the ASCII protocol |
 PanTiltPlugin | Plugin to drive pan/tilt units with Fawkes |
 PanTiltRX28Thread | PanTilt act thread for RX28 PTU |
 PanTiltSensorThread | Katana sensor thread |
 PanTiltSonyEviD100PThread | PanTilt act thread for the PTU part of the Sony EviD100P camera |
 PclViewerTransferThread | PCL viewer transfer thread |
 PlayerClientThread | Player Client Thread |
 PlayerF2PThread | Player Fawkes-To-Player Thread |
 PlayerLaserMapper | Laser mapper for player integration |
 PlayerMapperFactory | Player Fawkes mapper factory |
 PlayerMotorPositionMapper | Motor to position mapper for player integration |
 PlayerPlugin | Player plugin for Fawkes |
 PlayerPositionMapper | Position mapper for player integration |
 PlayerPostSyncThread | Synchronization thread Post Sync This thread is called in the POST_LOOP hook to synchronize a Player simulation loop and a Fawkes loop |
 PlayerProxyFawkesInterfaceMapper | Player proxy to Fawkes interface mapper interface |
 PlayerTimeSyncThread | Synchronization thread Time Sync This thread is called in the PRE_LOOP hook to synchronize a Player simulation loop and a Fawkes loop |
 PluginGuiGtkWindow | Graphical plugin management tool |
 PluginTool | Program to communicate with plugin manager via Fawkes network |
 PTUJoystickControl | Remote control PTUs via keyboard |
 ReadylogAgentPlugin | The Readylog agent plugin |
 RefBoxCommPlugin | Referee Box Communication Plugin for robotic soccer |
 RefBoxCommThread | Referee Box Communication Thread for robotic soccer |
 RefBoxProcessor | Referee Box Communication Processor |
 RefBoxStateBBWriter | RefBox repeater state writer |
 RefBoxStateHandler | Referee Box state handler for RefBoxProcessor |
 RefBoxStateSender | RefBox repeater state sender |
  TimeoutThread | Timeout thread |
 RemoteBlackBoardRefBoxProcessor | Remote BlackBoard refbox repeater |
 RetrieverConfigDialog | Config dialog of the config editor plugin for the fvretriever |
 RetrieverConfigPlugin | Config editor plugin for the fvretriever plugin |
 RobotinoActThread | Robotino act hook integration thread |
 RobotinoIrPclPlugin | Plugin to provide Robotino IR sensor as point cloud |
 RobotinoIrPclThread | Robotino IR distances as point cloud |
 RobotinoJoystickPlugin | Plugin to remote control a Robotino using a joystick |
 RobotinoJoystickThread | Robotino act hook integration thread |
 RobotinoPlugin | Plugin to provide Robotino platform support for Fawkes |
 RobotinoRosJointsPlugin | Plugin to publish Robotino joint info via ROS |
 RobotinoRosJointsThread | Robotino IR distances as point cloud |
 RobotinoSensorThread | Robotino sensor hook integration thread |
 RobotisRX28 | Class to access a chain of Robotis RX28 servos |
 Roomba500 | Roomba 500 series communication class |
  SensorPacketGroupAll | Struct for packet group with everything (SENSPACK_GROUP_ALL) |
 Roomba500Thread | Roomba 500 integration thread |
  WorkerThread | Worker thread for the Roomba 500 thread |
 RoombaJoystickPlugin | Control Roomba with a Joystick |
 RoombaJoystickThread | Roomba joystick control thread |
 RoombaPlugin | Plugin to interface with a Roomba robot |
 RoombaSensorThread | Roomba sensor hook integration thread |
 ROSCmdVelPlugin | Plugin to translate ROS Twist messages to Navigator transrot |
 ROSCmdVelThread | Thread to translate ROS twist messages to navigator transrot messages |
 RosImagesPlugin | Plugin exchange transforms between Fawkes and ROS |
 RosImagesThread | Thread to export Fawkes images to ROS |
 RosLaserScanPlugin | Plugin exchange laser scans between Fawkes and ROS |
 RosLaserScanThread | Thread to exchange point clouds between Fawkes and ROS |
 RosNavigatorPlugin | Send locomotion commands to ROS |
 RosNavigatorThread | Send Fawkes locomotion commands off to ROS |
 ROSNodeThread | ROS node handle thread |
 ROSOdometryPlugin | Plugin to publish odometry to ROS |
 ROSOdometryThread | Thread to publish odometry to ROS |
 ROSPlugin | Plugin to access ROS from Fawkes |
 RosPointCloudAdapter | Standalone PCL to ROS adapter class |
  PointFieldInfo | Information about the data fields |
 RosPointCloudPlugin | Plugin exchange transforms between Fawkes and ROS |
 RosPointCloudThread | Thread to exchange point clouds between Fawkes and ROS |
 ROSTalkerPubPlugin | Talker publisher example plugin |
 ROSTalkerPubThread | Thread to publish messages via ROS |
 RosTfPlugin | Plugin exchange transforms between Fawkes and ROS |
 RosTfThread | Thread to exchange transforms between Fawkes and ROS |
 ROSWebviewPlugin | ROS webview plugin |
 ROSWebviewRequestProcessor | Convert webview requests to ROS service calls |
 ROSWebviewThread | Provide webview to ROS |
 RRDExamplePlugin | RRD Example plugin |
 RRDExampleThread | RRD Example Thread |
 RRDPlugin | RRD manager plugin |
 RRDThread | RRD Thread |
 RRDWebPlugin | RRD Webview plugin |
 RRDWebRequestProcessor | RRD web request processor |
 RRDWebThread | RRD Webview Thread |
 SkelGuiDepthDrawer | Draw images from camera in texture |
 SkelGuiImageDrawer | Draw images from camera in texture |
 SkelGuiSkeletonDrawer | Draw body skeleton using OpenGL |
 SkelGuiSkeletonDrawer3D | Draw body skeleton using OpenGL (3D) |
 SkelGuiTextureDrawer | Draw images from camera in texture |
 SkillerExecutionThread | Skiller Execution Thread |
 SkillerPlugin | Skill Execution Runtime Plugin |
 SkillGuiBatchRenderer | DOT graph batch renderer |
 SkillGuiCairoRenderInstructor | Graphviz Cairo render plugin instructor |
 SkillGuiGraphDrawingArea | Graph drawing area |
 SkillGuiGraphViewport | Skill FSM Graph Viewport |
 SkillGuiGtkWindow | Skill GUI main window |
 SkillShellThread | Skill shell thread |
 SonyEviD100PVisca | Sony EviD100P Visca controller |
 spl_gamecontrol_t | SPL RefBox protocol game control struct |
 spl_robotinfo_t | SPL RefBox protocol robot info struct |
 spl_teaminfo_t | SPL RefBox protocol team info struct |
 SplRefBoxProcessor | SPL league refbox repeater |
 SplRefBoxRepeater | SPL league refbox repeater |
 StaticTransformsPlugin | Plugin to publish static transforms |
 StaticTransformsThread | Thread to regularly publish static transforms |
 SyncInterfaceListener | Synchronize two interfaces |
 SyncWriterInterfaceListener | Listener for writer events in bbsync plugin |
 TabletopObjectsPlugin | Plugin to segment a tabletop via PCL |
 TabletopObjectsThread | Main thread of tabletop objects plugin |
 TabletopVisualizationThread | Send Marker messages to rviz |
 TabletopVisualizationThreadBase | Base class for virtualization thread |
 TestPlugin | Simple test plugin for QA application |
 TfExamplePlugin | Plugin to publish static transforms |
 TfExampleThread | Main thread of tf example plugin |
 TimeTrackerMainLoopPlugin | Simple TimeTracker MainLoop plugin |
 TimeTrackerMainLoopThread | Main thread of time tracker main loop plugin |
 ToLuaInterfaceGenerator | Generator that transforms input from the InterfaceParser into valid ToLua++ package file |
 Visca | Visca control protocol implementation over a serial line |
 ViscaException | Visca exception |
 ViscaInquiryRunningException | Visca inquire running exception |
 VisualDisplay2D | 2D visualization processor for VisualDisplay2DInterface |
  Circle | Class representing a circle Line represented by its center point and radius |
  Line | Class representing a line |
  Rectangle | Class representing a rectangle |
  Shape | Class representing a shape |
  Text | Class representing a text object |
 WebviewBlackBoardRequestProcessor | BlackBoard web request processor |
 WebviewFooterGenerator | Webview page footer |
 WebviewHeaderGenerator | Webview page header |
 WebviewPlugin | Webview plugin for Fawkes |
 WebviewPluginsRequestProcessor | Plugins web request processor |
 WebviewServiceBrowseHandler | Browse handler to detect other Webview instances on the network |
 WebviewStartPageRequestProcessor | Web request processor for the start page |
 WebviewStaticRequestProcessor | Static file web processor |
 WebviewThread | Webview Thread |
 WebviewUserVerifier | Webview user verification |
 WorldInfoViewer | Main class of the WorldInfoViewer application |
 WorldInfoViewerBackendThread | The backend thread of the worldinfo viewer application |
 WorldModelFuser | Interface for data fusers for the world model |
 WorldModelMultiCopyFuser | Multi interface copy fuser |
 WorldModelNetworkThread | Network thread of worldmodel plugin |
 WorldModelObjPosAverageFuser | ObjectPositionModel average fuser |
 WorldModelObjPosMajorityFuser | ObjectPositionInterface majority fuser |
 WorldModelPlugin | Simple worldmodel plugin |
 WorldModelSingleCopyFuser | Single interface copy fuser |
 WorldModelThread | Main thread of worldmodel plugin |
 XabslEngineThread | Xabsl Engine Thread |
 XabslFileInputSource | File input class for Xabsl integration |
 XabslInterfaceFieldWrapper | Interface field wrapper for Xabsl |
 XabslLoggingErrorHandler | Logging error handler for XABSL integration |
 XabslPlugin | XABSL plugin for Fawkes |
 XabslSkillWrapper | Xabsl Skill Wrapper |
 XmlRpcLogMethods | Wrapper class for logging related XML-RPC methods |
  log_entries | Get most recent log entries via XML-RPC method |
  log_get_size | XML-RPC method to get the current cache log size |
  log_log | XML-RPC method to log a message |
  log_set_size | XML-RPC method to set maximum size of cache logger |
 XmlRpcPlugin | XmlRpc plugin for Fawkes |
 XmlRpcPluginMethods | Wrapper class for plugin related XML-RPC methods |
  plugin_list | Plugin list XML-RPC method |
  plugin_load | XML-RPC method to load a plugin |
  plugin_unload | XML-RPC method to unload a plugin |
 XmlRpcRequestProcessor | XML-RPC web request processor |
 XmlRpcThread | XML-RPC Thread |
 YUVSpaceDemo | YUV color space demo |
 YuvViewerGtkWindow | Tool to show the YUV color space |