File List

Here is a list of all files with brief descriptions:
algorithms/algorithms.h [code]
algorithms/AntiSimmetry/AntiSimmetry.cppDefinition of the methods raleted to the AntiSimmetry class
algorithms/AntiSimmetry/AntiSimmetry.h [code]Provides an anti simmetry control
algorithms/BiReg/BiReg.cppProvide a generic Binary registration algorithm between Observations
algorithms/BiReg/BiReg.h [code]Provides a generic class for binary registration between Observations
algorithms/BiReg/BiRegRANSAC.cpp
algorithms/BiReg/BiRegRANSAC.h [code]Provides a RANSAC implementation for the generic (virtual) BiReg class for binary registration between Observations
algorithms/DiffDriveOdometer/DiffDriveOdometer.cpp
algorithms/DiffDriveOdometer/DiffDriveOdometer.h [code]Algorithm which may be used to update the state of a differential drive. It makes use of the odometric equations
algorithms/FeatExtr/BearExtrCam.cpp
algorithms/FeatExtr/BearExtrCam.h [code]This file contains all definitions to perform a feature extraction algorithm from camera view
algorithms/FeatExtr/BearExtrCamStr.cpp
algorithms/FeatExtr/BearExtrCamStr.h [code]This file contains all the dependencies for the algorithm that extracts features from camera view
algorithms/FeatExtr/BearExtrCamUtils.cpp
algorithms/FeatExtr/BearExtrCamUtils.h [code]
algorithms/FeatExtr/EdgeExtr.cpp
algorithms/FeatExtr/EdgeExtr.h [code]This file contains all definitions to perform a edge extraction on a Scan looking for edges
algorithms/FeatExtr/ProtrusionExtr.cpp
algorithms/FeatExtr/ProtrusionExtr.h [code]This file contains all definitions to perform a edge extraction on a Scan looking for small protrusions
algorithms/FeatExtr/ReconKhCam.cpp
algorithms/FeatExtr/ReconKhCam.h [code]
algorithms/filters/EKF.cpp
algorithms/filters/EKF.h [code]Basic class for a generic Kalman Filter (linear KF,EKF,...)
algorithms/filters/FirFilter.cpp
algorithms/filters/FirFilter.h [code]Provides a simple class for Finite impulse response filter
algorithms/filters/IIRFilter.cpp
algorithms/filters/IIRFilter.h [code]Provides a simple class for Infinite impulse response recursive filter
algorithms/filters/LocUavFilter.cpp
algorithms/filters/LocUavFilter.h [code]TODO
algorithms/filters/RootEKF.cpp
algorithms/filters/RootEKF.h [code]Provides the basic methods of the EKF algorithm to be used in any specific implementation
algorithms/filters/SimpleFilter.cpp
algorithms/filters/SimpleFilter.h [code]TODO
algorithms/FormationControl/FormationControl.cpp
algorithms/FormationControl/FormationControl.h [code]
algorithms/FormationControl/FormControlMsgs.h [code]
algorithms/FormationControl/FormCtrlShape.cpp
algorithms/FormationControl/FormCtrlShape.h [code]
algorithms/LaserNavigation/LaserNavigation.cppSimple laser navigation algorithm for pseudo random autonomous navigation
algorithms/LaserNavigation/LaserNavigation.h [code]Simple laser navigation algorithm for pseudo random autonomous navigation
algorithms/Localization/CLPaFil.cppImplementation ( Particle Filtering ) of the localization filter class s
algorithms/Localization/CLPaFil.h [code]Implementation ( Particle Filtering ) of the localization filter class
algorithms/Localization/Kalman.cppImplementation ( Kalman Filtering ) of the kalman filter class s
algorithms/Localization/Kalman.h [code]Implementation of an Extended Kalman Filter (EKF)
algorithms/Localization/KalmanImu.cppImplementation ( Kalman Filtering ) of the kalman filter class s
algorithms/Localization/KalmanImu.h [code]Implementation of an Extended Kalman Filter (EKF)
algorithms/MobRob2DController/mobRob2DPIDController.cpp
algorithms/MobRob2DController/mobRob2DPIDController.h [code]
algorithms/MultiReg/MultiReg.cpp
algorithms/MultiReg/MultiReg.h [code]Generic class for multiple registration algorithm between Observations
algorithms/MultiReg/MultiRegCam.cppCompute all possible triangle, i.e. three possible robots that have angles sum equal to pi
algorithms/MultiReg/MultiRegCam.h [code]Provides the triangle robot formation
algorithms/MultiReg/MultiRegCamStr.cpp
algorithms/MultiReg/MultiRegCamStr.h [code]Provides structures for MultiRegCam
algorithms/MultiReg/MultiRegSol.cpp
algorithms/MultiReg/MultiRegSol.h [code]Generic class for multiple registration algorithm between Observations
algorithms/MultiReg/MutLocQuad.cpp
algorithms/MultiReg/MutLocQuad.h [code]Provides mutual localization algorithm for quadcopters
algorithms/MultiReg/MutLocQuadStereoCam.cpp
algorithms/MultiReg/MutLocQuadStereoCam.h [code]
algorithms/MultiReg/ProbMultiReg.cpp
algorithms/MultiReg/ProbMultiReg.h [code]Class for multiple registration algorithm between Observations
algorithms/MultiReg/ProbMultiRegCam.cppCompute all possible triangle, i.e. three possible robots that have angles sum equal to pi
algorithms/MultiReg/ProbMultiRegCam.h [code]Provides the triangle robot formation
algorithms/MultiReg/ProbMultiRegCam3D.cpp
algorithms/MultiReg/ProbMultiRegCam3D.h [code]Provides the triangle robot formation
algorithms/MultiReg/ProbMultiRegCam3DStr.cpp
algorithms/MultiReg/ProbMultiRegCam3DStr.h [code]
algorithms/MultiReg/ProbMultiRegCamStr.cpp
algorithms/MultiReg/ProbMultiRegCamStr.h [code]Provides structures for ProbMultiRegCam
algorithms/MultiReg/ProbMultiRegStereoCam3D.cpp
algorithms/MultiReg/ProbMultiRegStereoCam3D.h [code]
algorithms/MultiReg/ProbMultiRegStereoCam3DStr.cpp
algorithms/MultiReg/ProbMultiRegStereoCam3DStr.h [code]
algorithms/MutLoc/DAEKF.cppImplementation (Data-Association + Extended Kalman filtering) of the localization filter class
algorithms/MutLoc/DAEKF.h [code]Provides an implementation (Data-Association + Extended Kalman filtering) of the localization filter class
algorithms/MutLoc/MutLoc.cppGeneric class for localization filter
algorithms/MutLoc/MutLoc.h [code]Provides a generic class for mutual localization filter
algorithms/MutLoc/MutLocFASTSlam.cpp
algorithms/MutLoc/MutLocFASTSlam.h [code]
algorithms/MutLoc/PaFil.cppProvides an implementation ( Particle Filtering ) of the localization filter class
algorithms/MutLoc/PaFil.h [code]Implementation ( Particle Filtering ) of the localization filter class
algorithms/MutLoc/PaFilBFL.cppProvides the generic orocos-bfl implementation of the mutual localization filter class
algorithms/MutLoc/PaFilBFL.h [code]Provides the generic orocos-bfl implementation of the mutual localization filter class
algorithms/MutLoc/PaFilBFLAbsRel.cppProvides an implementation ( RelParticle Filtering ) of the localization filter class s
algorithms/MutLoc/PaFilBFLAbsRel.h [code]Provides the Absolute frame - Relative frame implementation of the mutual localization filter class using orocos-bfl particle filter
algorithms/MutLoc/PaFilBFLRelRel.cppProvides an implementation ( RelParticle Filtering ) of the localization filter class s
algorithms/MutLoc/PaFilBFLRelRel.h [code]Provides the Absolute frame - Relative frame implementation of the mutual localization filter class using orocos-bfl particle filter
algorithms/MutLoc/PaFilBFLRelRel3D.cppProvides an implementation ( RelParticle Filtering ) of the localization filter class s
algorithms/MutLoc/PaFilBFLRelRel3D.h [code]Provides the Absolute frame - Relative frame implementation of the mutual localization filter class using orocos-bfl particle filter
algorithms/MutLoc/PaFilBFLRelRelBearOnly.cppProvides an implementation ( RelParticle Filtering ) of the localization filter class s
algorithms/MutLoc/PaFilBFLRelRelBearOnly.h [code]Provides the Absolute frame - Relative frame implementation of the mutual localization filter class using orocos-bfl particle filter
algorithms/MutLoc/PaFilBFLRelRelBearOnly3D.cppProvides an implementation ( RelParticle Filtering ) of the localization filter class s
algorithms/MutLoc/PaFilBFLRelRelBearOnly3D.h [code]Provides the Absolute frame - Relative frame implementation of the mutual localization filter class using orocos-bfl particle filter
algorithms/MutLoc/PaFilBFLRelRelBearOnly3Dvel.cppProvides an implementation ( RelParticle Filtering ) of the localization filter class s
algorithms/MutLoc/PaFilBFLRelRelBearOnly3Dvel.h [code]Provides the Absolute frame - Relative frame implementation of the mutual localization filter class using orocos-bfl particle filter
algorithms/MutLoc/PaFilBFLRelRelBearOnly3DvelUpdate.cppProvides an implementation ( RelParticle Filtering ) of the localization filter class
algorithms/MutLoc/PaFilBFLRelRelBearOnly3DvelUpdate.h [code]Provides the Absolute frame - Relative frame implementation of the mutual localization filter class using orocos-bfl particle filter
algorithms/MutLoc/PaFilBFLRelRelNoMR.cppProvides an implementation ( RelParticle Filtering ) of the localization filter class s
algorithms/MutLoc/PaFilBFLRelRelNoMR.h [code]Provides the Absolute frame - Relative frame implementation of the mutual localization filter class using orocos-bfl particle filter
algorithms/MutLoc/RelPaFil.cppImplementation ( RelParticle Filtering ) of the localization filter class s
algorithms/MutLoc/RelPaFil.h [code]Implementation ( RelParticle Filtering ) of the mutual localization filter class
algorithms/ObsAvoiAlgo/AlgoVFH.cpp
algorithms/ObsAvoiAlgo/AlgoVFH.h [code]
algorithms/ObsAvoiAlgo/ObsAvoiAlgo.cpp
algorithms/ObsAvoiAlgo/ObsAvoiAlgo.h [code]Generic class for obstacle avoidance algorithms
algorithms/ObsAvoiAlgo/ObsAvoiAlgoDyn.cppObstacle avoidance for double integrators
algorithms/ObsAvoiAlgo/ObsAvoiAlgoDyn.h [code]
algorithms/ObsAvoiAlgo/ObsAvoiAlgoLIP.cppObstacle avoidance with artificial potential method
algorithms/ObsAvoiAlgo/ObsAvoiAlgoLIP.h [code]
algorithms/ObsAvoiAlgo/ObsAvoiAlgoPFM.cpp
algorithms/ObsAvoiAlgo/ObsAvoiAlgoPFM.h [code]Class for potential field method obstacle avoidance
algorithms/ObsAvoiAlgo/ObsAvoiAlgoPFMKinect.cpp
algorithms/ObsAvoiAlgo/ObsAvoiAlgoPFMKinect.h [code]
algorithms/ObsAvoiAlgo/ObsAvoiAlgoSND.cppObstacle avoidance with nearness diagram method
algorithms/ObsAvoiAlgo/ObsAvoiAlgoSND.h [code]
algorithms/ObsAvoiAlgo/ObsAvoiAlgoVFH.cpp
algorithms/ObsAvoiAlgo/ObsAvoiAlgoVFH.h [code]Class for vector field histogram obstacle avoidance
algorithms/Odometry/Odometry.cpp
algorithms/Odometry/Odometry.h [code]Provides a simple class for the integration of encoders lectures
algorithms/Odometry/Odometry3D.cpp
algorithms/Odometry/Odometry3D.h [code]Provides a simple class for the integration of encoders lectures
algorithms/Odometry/VisualOdometry.cpp
algorithms/Odometry/VisualOdometry.h [code]Provides a generic class for visual tracking algorithm
algorithms/Odometry/VisualOdometryPTAMM.cpp
algorithms/Odometry/VisualOdometryPTAMM.h [code]
algorithms/OpticalFlow/basicOpticalFlow.cpp
algorithms/OpticalFlow/basicOpticalFlow.h [code]Provides a class for optical flow extraction (based on OpenCV libs)
algorithms/PassivityAlgos/Pspm.cpp
algorithms/PassivityAlgos/Pspm.h [code]
algorithms/PathPlanner/PathPlanner.cpp
algorithms/PathPlanner/PathPlanner.h [code]
algorithms/PathPlanner/PathPlanner2.cpp
algorithms/PHDFilter/EKFilterUnicycle2D.cppProvides the methods for the PHD filter for tracking of multiple objects in a 2D world
algorithms/PHDFilter/EKFilterUnicycle2D.h [code]This file contains all the abstract definitions for the PHD filter for tracking of multiple objects in a 2D world
algorithms/PHDFilter/GMIDPHDUnicycle2DRCFilter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMIDPHDUnicycle2DRCFilter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDLinear2DTargetNoIdFilter.cppProvides the methods for the Gaussian mixture implementation of the PHD filter for tracking of multiple objects in a 2D world
algorithms/PHDFilter/GMPHDLinear2DTargetNoIdFilter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple objects in a 2D world. The model used in the filter is a linear model. The state of the single target is a vector of n elements. The Ids of the targets are not part of the state. The filter is tested for 2-dimensional state vectors, but in principle should for the generic n-dimensional case. The limitation to the 2D scenario is due to the imput class that takes a classical 2D input, that is positions and odometry of all of all the robots
algorithms/PHDFilter/GMPHDUnicycle2DCamIdRCFilter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DCamIdRCFilter.h [code]
algorithms/PHDFilter/GMPHDUnicycle2DIdCentrFilter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DIdCentrFilter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDUnicycle2DIdCoop3Filter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DIdCoop3Filter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDUnicycle2DIdCoop4Filter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DIdCoop4Filter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDUnicycle2DIdCoopFilter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DIdCoopFilter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDUnicycle2DIdCoopFilter2.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DIdCoopFilter2.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDUnicycle2DIdCoopRCFilter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DIdCoopRCFilter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDUnicycle2DIdFilter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DIdFilter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDUnicycle2DIdRCFilter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DIdRCFilter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/GMPHDUnicycle2DNoIdFilter.cppThis file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world
algorithms/PHDFilter/GMPHDUnicycle2DNoIdFilter.h [code]This file provides the gaussian mixture implementation of the PHD filter for tracking of multiple unicycles in a 2D world. The Ids of the target are part of the state
algorithms/PHDFilter/PHDFilter.cppProvides the methods for the PHD filter for tracking of multiple objects in a 2D world
algorithms/PHDFilter/PHDFilter.h [code]This file contains all the abstract definitions for the PHD filter for tracking of multiple objects in a 2D world
algorithms/PHDFilter/PHDIDRansac.cppProvides the methods for the PHD filter for tracking of multiple objects in a 2D world
algorithms/PHDFilter/PHDIDRansac.h [code]This file contains all the classes for a Ransac algorithm executed on the output of two PHD filters for tracking of multiple objects in a 2D world
algorithms/PHDFilter/PHDRansac.cppProvides the methods for the PHD filter for tracking of multiple objects in a 2D world
algorithms/PHDFilter/PHDRansac.h [code]This file contains all the classes for a Ransac algorithm executed on the output of two PHD filters for tracking of multiple objects in a 2D world
algorithms/TrajControl/TrajControl.cpp
algorithms/TrajControl/TrajControl.h [code]
algorithms/UavAutopilot/UavAutopilot.cpp
algorithms/UavAutopilot/UavAutopilot.h [code]Generate references for standard manouvers of Uavs
algorithms/UavControl/UavControl.cpp
algorithms/UavControl/UavControl.h [code]
algorithms/VisualNavigation/VisNavKF.cppProvides an implementation of the Kalman Filter for visual navigation for fusion of IMU sensor and PTAM data
algorithms/VisualNavigation/VisNavKF.h [code]Provides an implementation of the Kalman Filter for visual navigation for fusion of IMU sensor and PTAM data
algorithms/VisualTracking/VisTrackCamshift.cpp
algorithms/VisualTracking/VisTrackCamshift.h [code]
algorithms/VisualTracking/VisTrackVisp.cpp
algorithms/VisualTracking/VisTrackVisp.h [code]
algorithms/VisualTracking/VisualTracking.cpp
algorithms/VisualTracking/VisualTracking.h [code]Provides a generic class for visual tracking algorithm
algorithms/Voronoi/Voronoi.cpp
algorithms/Voronoi/Voronoi.h [code]Calculate voronoi diagram of a point-set and some geometric centers based on the voronoi regions
algorithms/VPPlanner/Frontier.cpp
algorithms/VPPlanner/Frontier.h [code]
algorithms/VPPlanner/Grid.cpp
algorithms/VPPlanner/Grid.h [code]
algorithms/VPPlanner/LRR.cpp
algorithms/VPPlanner/LRR.h [code]
algorithms/VPPlanner/VPPlanner.cpp
algorithms/VPPlanner/VPPlanner.h [code]
baselib/applePatch.h [code]
baselib/baselib.cpp
baselib/baselib.h [code]
baselib/ExplorationGraph/ExplorationGraph.cpp
baselib/ExplorationGraph/ExplorationGraph.h [code]
baselib/ExplorationGraph/ExplorationGraphProva.cppHeader
baselib/ExplorationGraph/ExplorationGraphProva.h [code]Header
baselib/ExtString/ExtString.cpp
baselib/ExtString/ExtString.h [code]Provides a class derived from string that has some additional features
baselib/FifoConn/FifoListen.cpp
baselib/FifoConn/FifoListen.h [code]
baselib/FifoConn/FifoSend.cpp
baselib/FifoConn/FifoSend.h [code]Fornisce una semplice classe per l'invio di messaggi utilizzando le named pipes
baselib/FifoConn/FifoStructs.h [code]
baselib/FifoTerm/FifoServer.cpp
baselib/FifoTerm/FifoTerm.cpp
baselib/FifoTerm/FifoTerm.h [code]Fornisce una semplice classe per la stampa su un terminale
baselib/File/File.cpp
baselib/File/File.h [code]Simple class to manage files
baselib/Graph/Connectivity.cpp
baselib/Graph/Connectivity.h [code]Manage 2D R-disk connectivity (symmetric)
baselib/Graph/Graph.cpp
baselib/Graph/Graph.h [code]
baselib/Grid/Grid.cpp
baselib/Grid/Grid.h [code]
baselib/Grid/PerceptionGrid.cpp
baselib/Grid/PerceptionGrid.h [code]
baselib/IP/IP.h [code]
baselib/IP/socketTCP.cppClasses for the tcp-ip communication module
baselib/IP/socketTCP.h [code]Classes for the tcp-ip communication module
baselib/IP/socketUDP.cppClasses for the udp-ip communication module
baselib/IP/socketUDP.h [code]Classes for the udp-ip communication module
baselib/LinuxShMem/LinuxShMem.cppClasses for accessing shared memory
baselib/LinuxShMem/LinuxShMem.h [code]Classes for accessing shared memory
baselib/LogTrace/LogTrace.cppProvide a simple class to manage threads
baselib/LogTrace/LogTrace.h [code]Simple class for logging and tracing
baselib/Message/Message.cpp
baselib/Message/Message.h [code]SharedListener
baselib/MIPMatrix/MIPMatrix.cppBasic class for simple Matrices to do
baselib/MIPMatrix/MIPMatrix.h [code]Basic class for simple Matrices
baselib/Options/CommonOptions.cpp
baselib/Options/CommonOptions.h [code]Header
baselib/Options/Option.cppHeader
baselib/Options/Option.h [code]Header
baselib/Options/optionWidgets.cpp
baselib/Options/optionWidgets.h [code]
baselib/Options/RawOptionsContainer.cpp
baselib/Options/RawOptionsContainer.h [code]
baselib/PDFs/Discrete.cppProvides the methods for the class Discrete
baselib/PDFs/Discrete.h [code]This file contains the definition of the class representing a Discrete PDF. This file uses the Armadillo library for linear algebra
baselib/PDFs/Gaussian.cppProvides the methods for the class Gaussian
baselib/PDFs/Gaussian.h [code]This file contains the definition of the class representing a Gaussian PDF. This file uses the Armadillo library for linear algebra
baselib/PDFs/GaussianMixture.cppProvides the methods for the classes related with the class GaussianMixture
baselib/PDFs/GaussianMixture.h [code]This file contains the class representing a Gaussian Mixture pdf
baselib/PDFs/PDF.cppProvides the methods for the PDFs and PHDs
baselib/PDFs/PDF.h [code]This file contains the definition of the abstract class PDF
baselib/ROS/includeROS.h [code]
baselib/ROS/ROSiFace.cpp
baselib/ROS/ROSiFace.h [code]Simple wrapper of ROS publisher/subscriber
baselib/Roulette/Roulette.cpp
baselib/Roulette/Roulette.h [code]This file provides a simple class to simulate a (un)weighted roulette-like random process
baselib/sensors/CameraParameters.cpp
baselib/sensors/CameraParameters.h [code]
baselib/sensors/Scan.cpp
baselib/sensors/Scan.h [code]Contains the Scan class
baselib/sensors/ScanMap.cpp
baselib/sensors/ScanMap.h [code]Contains the ScanMap class
baselib/sensors/ScanTypes.h [code]
baselib/sensors/sensors.h [code]Header
baselib/Serialization/Serialization.cpp
baselib/Serialization/Serialization.h [code]Serialization for common classes
baselib/SharedListener/CharKeybSharList.cpp
baselib/SharedListener/CharKeybSharList.h [code]
baselib/SharedListener/FifoSharList.cpp
baselib/SharedListener/FifoSharList.h [code]Todo
baselib/SharedListener/SharedListener.cpp
baselib/SharedListener/SharedListener.h [code]SharedListener
baselib/SharedListener/StringKeybSharList.cpp
baselib/SharedListener/StringKeybSharList.h [code]
baselib/SharedListener/UDPSharedListener.cpp
baselib/SharedListener/UDPSharedListener.h [code]UDPSharedListener
baselib/smInterfaces/CsmInterface.cpp
baselib/smInterfaces/CsmInterface.h [code]
baselib/Spaces/BoundBox.cpp
baselib/Spaces/BoundBox.h [code]
baselib/Spaces/Odometry2D.cpp
baselib/Spaces/Odometry2D.h [code]
baselib/Spaces/PoseFeatures.cpp
baselib/Spaces/PoseFeatures.h [code]Basic classes for vectors in SE(2)
baselib/Spaces/R2.cpp
baselib/Spaces/R2.h [code]Basic classes related to vectors in R^2
baselib/Spaces/R2Arma.cpp
baselib/Spaces/R2Arma.h [code]
baselib/Spaces/R3.cpp
baselib/Spaces/R3.h [code]Basic classes related to vectors in R^3
baselib/Spaces/R3Arma.cpp
baselib/Spaces/R3Arma.h [code]
baselib/Spaces/S1.cpp
baselib/Spaces/S1.h [code]Basic classes for vectors in S^1
baselib/Spaces/S1m.cpp
baselib/Spaces/S1m.h [code]
baselib/Spaces/S3.cpp
baselib/Spaces/S3.h [code]Basic classes related to orientation in R^3
baselib/Spaces/S3New.cpp
baselib/Spaces/S3New.h [code]
baselib/Spaces/SE2.cpp
baselib/Spaces/SE2.h [code]Basic classes for vectors in SE(2)
baselib/Spaces/SE3.cpp
baselib/Spaces/SE3.h [code]Basic classes for vectors in SE(3)
baselib/Spaces/Spaces.h [code]Basic classes related to geometrical spaces
baselib/Spaces/SpacesArma.h [code]Basic classes related to geometrical spaces
baselib/Spaces/TimeStampedPose.cpp
baselib/Spaces/TimeStampedPose.h [code]
baselib/SsUtils/SsUtils.cpp
baselib/SsUtils/SsUtils.h [code]Provide a basic for encrypting/decrypting classes in/from a stringstream
baselib/Surface/Surface.cpp
baselib/Surface/Surface.h [code]Basic class for surface in 3D space
baselib/Thread/Thread.cppThis file provides a simple class to manage threads
baselib/Thread/Thread.h [code]This file provides a simple class to manage threads
baselib/Time/SimTime.cpp
baselib/Time/SimTime.h [code]A class for non real time simulation time
baselib/Time/Time.cpp
baselib/Time/Time.h [code]Basic class for time
baselib/tools/Association.cpp
baselib/tools/Association.h [code]
baselib/tools/numTools.cppSome numeric tools classes
baselib/tools/numTools.h [code]Some numeric tools classes
baselib/tools/ublasTools.h [code]
baselib/Trajectory/Path.cppDefinition of path classes
baselib/Trajectory/Path.h [code]Contains the declarations of path classes
baselib/Trajectory/TimeLaw.cppDefinition of time law classes
baselib/Trajectory/TimeLaw.h [code]Contains the declarations of time law classes
baselib/Trajectory/Trajectory.cpp
baselib/Trajectory/Trajectory.h [code]Contains the declarations of Trajectory class
baselib/Types/structQuad.h [code]Header
baselib/Types/Types.h [code]Header
baselib/Unicycle/DiffDriveLib.cpp
baselib/Unicycle/DiffDriveLib.h [code]Abstract class for a reading libs for an encoder
baselib/Unicycle/MotionModuleState.cpp
baselib/Unicycle/MotionModuleState.h [code]Contains the implementation class for motion module state (of a unicycle) and state with time
baselib/VrpnTracker/VrpnTracker.cpp
baselib/VrpnTracker/VrpnTracker.h [code]
docs/doxypages/kh3Basics.h [code]
docs/doxypages/mainpage.h [code]
docs/doxypages/manual.h [code]
docs/doxypages/MIPBuild.h [code]
docs/doxypages/MIPExamples.h [code]
docs/doxypages/MIPPlugins.h [code]
docs/doxypages/MIPRun.h [code]
docs/doxypages/MIPTests.h [code]
docs/doxypages/works/deployment.h [code]
docs/doxypages/works/entrapment.h [code]
docs/doxypages/works/goalNav.h [code]
docs/doxypages/works/joystick.h [code]
docs/doxypages/works/lineFoll.h [code]
docs/doxypages/works/mapping.h [code]
docs/doxypages/works/mutLoc.h [code]
docs/doxypages/works/pfilLoc.h [code]
docs/doxypages/works/quad.h [code]
docs/doxypages/works/scanMatching.h [code]
docs/doxypages/works/srgDemo.h [code]
docs/doxypages/works/tracc.h [code]
docs/doxypages/works/works.h [code]
main/main.h [code]
main/custom/egraph/egraph.cpp
main/custom/egraph/EGraph/args.h [code]
main/custom/egraph/EGraph/EGraph.cpp
main/custom/egraph/EGraph/EGraph.h [code]
main/custom/egraph/EGraph/EGraphPlayerIF.cpp
main/custom/egraph/EGraph/EGraphPlayerIF.h [code]
main/custom/egraph/EGraph/EGraphTemp.h [code]
main/custom/egraph/EGraph/utils.h [code]
main/Main/Main.cppMain of MIP
main/Main/MainWindow.cpp
main/Main/MainWindow.h [code]Main window
main/RemKhepServer/main.cppThis is the main program to run on a khepera3 in experiments
main/RemKhepServer/mainROS.cppThis is the main program to run on a khepera3 in experiments
main/RemKhepServer/mainROS.h [code]This is the main program (header file) to run on a khepera3 in experiments
main/RemKhepServer/RemKhepServer.cpp
main/RemKhepServer/RemKhepServer.h [code]
main/RemKhepServer/RemKhepServerROS.cpp
main/RemKhepServer/RemKhepServerROS.h [code]
main/RemKhepServer/RemKhepServerROSController.cpp
main/RemKhepServer/RemKhepServerROSController.h [code]
main/RemKhepServer/RemKhepServerROSPluginFuerte.cpp
main/RemKhepServer/RemKhepServerROSPluginFuerte.h [code]
main/Scheduler/NewScheduler-386.cpp
main/Scheduler/NewScheduler.h [code]Scheduler task
main/Scheduler/QtScheduler.cpp
main/Scheduler/QtScheduler.h [code]
main/Scheduler/QtThreadSched.cpp
main/Scheduler/QtThreadSched.h [code]
main/Scheduler/Scheduler-386.cpp
main/Scheduler/Scheduler-ARM.cpp
main/Scheduler/Scheduler.h [code]Scheduler task
main/Scheduler/Tasks-Resources-386.h [code]
main/Scheduler/Tasks-Resources-ARM.h [code]
resources/resources.h [code]
resources/Camera/Camera.cpp
resources/Camera/Camera.h [code]Video Camera abstract class
resources/Camera/CameraCVD.cpp
resources/Camera/CameraCVD.h [code]Class for video cameras that need libCVD
resources/Camera/CameraROS.cpp
resources/Camera/CameraROS.h [code]Video Camera class to interface ROS cameras
resources/CommModule/CommModule.cpp
resources/CommModule/CommModule.h [code]Contains the abstract class for a Comunication Module
resources/CommModule/DirectStreamCommModule.cppImplementation class of Direct streamfor the CommModule
resources/CommModule/DirectStreamCommModule.h [code]Implementation class of direct stream for the CommModule
resources/CommModule/IPCommModule.cppImplementation class of Internet Protocol for the CommModule
resources/CommModule/IPCommModule.h [code]Implementation class of Internet Protocol for the CommModule
resources/CommModule/YellowPages.cpp
resources/CommModule/YellowPages.h [code]
resources/DraWin/DraWin.cpp
resources/DraWin/DraWin.h [code]
resources/DraWin/DraWinGL.cpp
resources/DraWin/DraWinGL.h [code]
resources/DraWin/DraWinGLcb.cpp
resources/DraWin/DraWinGLcb.h [code]
resources/DraWin/DraWinObj.cpp
resources/DraWin/DraWinObj.h [code]
resources/DraWin/DraWinQt2D.cpp
resources/DraWin/DraWinQt2D.h [code]
resources/DraWin/DraWinQtGL.cpp
resources/DraWin/DraWinQtGL.h [code]
resources/DScope/DScope.cpp
resources/DScope/DScope.h [code]
resources/DScope/DsMainWin.cpp
resources/DScope/DsMainWin.h [code]Main window
resources/DScope/DsMessage.cpp
resources/DScope/DsMessage.h [code]
resources/DScope/DsSender.cpp
resources/DScope/DsSender.h [code]
resources/DScope/DsSession.cpp
resources/DScope/DsSession.h [code]
resources/DScope/DsTypes.h [code]
resources/ExternScanMatch/ExternScanMatch.cpp
resources/ExternScanMatch/ExternScanMatch.h [code]
resources/GroundSens/GroundSens.cpp
resources/GroundSens/GroundSens.h [code]Contains the abstract class for Ground Sensing Devices
resources/GroundSens/TCRT5000Ground.cpp
resources/GroundSens/TCRT5000Ground.h [code]Implementation class for a Player/Stage Ground Sensor
resources/Imu3D/Imu3D.cpp
resources/Imu3D/Imu3D.h [code]
resources/Imu_sensor/Imu_sensor.cpp
resources/Imu_sensor/Imu_sensor.h [code]Imu abstract class
resources/Keyboard/Keyboard.cpp
resources/Keyboard/Keyboard.h [code]Minimal class for containing stdin data
resources/MobileRob/KheperaIII.cpp
resources/MobileRob/KheperaIII.h [code]Implementation class for KheperaII Mobile Robot
resources/MobileRob/MobileRob.cpp
resources/MobileRob/MobileRob.h [code]Mobile Robots abstract class
resources/MobileRob/MRControlInput.cpp
resources/MobileRob/MRControlInput.h [code]
resources/MobileRob/OfflineMR.cpp
resources/MobileRob/OfflineMR.h [code]Class for the simulation of an offline mobile robot
resources/MobileRob/remKhepComm.h [code]
resources/MobileRob/RemoteKhepera.cpp
resources/MobileRob/RemoteKhepera.h [code]Contains the implementation class for RemoteKhepera Mobile Robot TCP interface
resources/MobileRob/RemoteRob.cpp
resources/MobileRob/RemoteRob.h [code]Contains the implementation class for RemoteRob Mobile Robot TCP interface
resources/MobileRob3D/MobileRob3D.cpp
resources/MobileRob3D/MobileRob3D.h [code]Mobile Robots abstract class in 3D
resources/MobileRob3D/SuperMario.cpp
resources/MobileRob3D/SuperMario.h [code]Implementation class for SuperMario Mobile Robot
resources/MotionModule/Korebot.cpp
resources/MotionModule/Korebot.h [code]
resources/MotionModule/KorebotROS.cpp
resources/MotionModule/KorebotROS.h [code]Implementation class for the korebot Motion Module
resources/MotionModule/MotionModule.cpp
resources/MotionModule/MotionModule.h [code]Abstract class for a Motion Module (Unicycle) of a Mobile Robot
resources/MotionModule/OldKorebot.cpp
resources/MotionModule/RemoteMotionModule.cpp
resources/MotionModule/RemoteMotionModule.h [code]Implementation class for a Remote Range Sensor (a motion module on a remote robot)
resources/MotionModule/WebotsDiffDrive.cpp
resources/MotionModule/WebotsDiffDrive.h [code]Implementation class for the Webots generic Differential drive
resources/MotionModule/WebotsKoremot.cpp
resources/MotionModule/WebotsKoremot.h [code]Implementation class for the Webots Khepera Differential drive
resources/MotionModule3D/MotionModule3D.cpp
resources/MotionModule3D/MotionModule3D.h [code]Abstract class for a Motion Module 3D (Unicycle3D) of a Mobile Robot
resources/PositionDetector/PositionDetector.cpp
resources/PositionDetector/PositionDetector.h [code]Abstract class for Global Positioning System Devices in 2D space
resources/PositionDetector3D/PositionDetector3D.cpp
resources/PositionDetector3D/PositionDetector3D.h [code]Abstract class for Global Positioning System Devices
resources/RangeSens/RangeSens.cpp
resources/RangeSens/RangeSens.h [code]Contains the abstract class for Range Sensing Devices
resources/RangeSens/RemoteRangeSens.cpp
resources/RangeSens/RemoteRangeSens.h [code]
resources/RangeSens/TCRT5000.cpp
resources/RangeSens/TCRT5000.h [code]Implementation class for a Player/Stage Range Sensor
resources/RangeSens/URG04LX.cppDefinition of methods relevant to class URG04LX (sensor) and its composing subclasses
resources/RangeSens/URG04LX.h [code]Implementation class for Hokuyo URG04LX Laser Range Sensor
resources/RangeSens/URG04LXenums.h [code]Implementation class for Hokuyo URG04LX Laser Range Sensor
resources/RangeSens/URG04LXmm.cppDefinition of methods relevant to class URG04LX (sensor) and its composing subclasses
resources/RangeSens/URG04LXmm.h [code]Contains the implementation class for Hokuyo URG04LX Laser Range Sensor
resources/RemoteDevice/RemoteDevice.cpp
resources/RemoteDevice/RemoteDevice.h [code]Contains the implementation class for the RemoteDevice
resources/Resource/Resource.cpp
resources/Resource/Resource.h [code]Abstract class for resources
resources/Resource/ResourceDict.h [code]Resources dictionary
resources/Resource/ResourceFactory.h [code]
resources/ROSNode/include_geometry_msgs_Point.h [code]
resources/ROSNode/include_geometry_msgs_PointStamped.h [code]
resources/ROSNode/include_geometry_msgs_Twist.h [code]
resources/ROSNode/include_geometry_msgs_Vector3Stamped.h [code]
resources/ROSNode/include_nav_msgs_Odometry.h [code]
resources/ROSNode/include_sensor_msgs_CameraInfo.h [code]
resources/ROSNode/include_sensor_msgs_Image.h [code]
resources/ROSNode/include_sensor_msgs_Imu.h [code]
resources/ROSNode/include_sensor_msgs_LaserScan.h [code]
resources/ROSNode/include_sensor_msgs_Range.h [code]
resources/ROSNode/include_std_msgs_Header.h [code]
resources/ROSNode/include_std_msgs_Int32.h [code]
resources/ROSNode/include_std_msgs_String.h [code]
resources/ROSNode/include_TEMPLATE_MSGS.h [code]
resources/ROSNode/ROSNode.cpp
resources/ROSNode/ROSNode.h [code]This file contains a class to interface MIP as a ROS node
resources/SharedMem/SharedMem.cppClass for memory shared between different tasks
resources/SharedMem/SharedMem.h [code]Class for memory shared between different tasks
resources/Uav/asctecUav.cpp
resources/Uav/asctecUav.h [code]
resources/Uav/HBstructs.h [code]
resources/Uav/HummingBirdUav.cpp
resources/Uav/HummingBirdUav.h [code]
resources/Uav/HummingBirdUavComm.cpp
resources/Uav/HummingBirdUavComm.h [code]
resources/Uav/OfflineUav.cpp
resources/Uav/OfflineUav.h [code]Class for the simulation of an offline UAV quadrotor
resources/Uav/Uav.cpp
resources/Uav/Uav.h [code]Unmanned air vehicle abstract class
tasks/tasks.h [code]
tasks/AntiSimmetryTask/AntiSimmetryTask.cpp
tasks/AntiSimmetryTask/AntiSimmetryTask.h [code]Provides a task for the execution of an anti simmetry control law for a MultiRobot system
tasks/ClearingTask/ClearingMobileRobot.cpp
tasks/ClearingTask/ClearingMobileRobot.h [code]
tasks/ClearingTask/ClearingTask.cpp
tasks/ClearingTask/ClearingTask.h [code]Clearing task
tasks/ClearingTask/utils.h [code]
tasks/Cloche/Cloche.cpp
tasks/Cloche/Cloche.h [code]Task that allow to command a uav robot with the keyboard
tasks/Deploy/Deploy.cpp
tasks/Deploy/Deploy.h [code]Deployment task
tasks/Driver/Driver.cpp
tasks/Driver/Driver.h [code]Driver task: retrieve and set commands to control robot towards a goal
tasks/EmergencyLock/EmergencyLock.cpp
tasks/EmergencyLock/EmergencyLock.h [code]Emergency lock task to do
tasks/ExampleTask/ExampleTask.cpp
tasks/ExampleTask/ExampleTask.h [code]Example task. to do
tasks/FeatExtrCam/FeatExtrCam.cpp
tasks/FeatExtrCam/FeatExtrCam.h [code]Task for Uav visual hovering on a specified target (Requires a Camera resource)
tasks/FeatExtrTask/FeatExtrTask.cpp
tasks/FeatExtrTask/FeatExtrTask.h [code]Feature extractor task, to do
tasks/FormControl/FormControl.cpp
tasks/FormControl/FormControl.h [code]
tasks/FormUpdate/FormUpdate.cpp
tasks/FormUpdate/FormUpdate.h [code]Task for formation update without mutual localization
tasks/Joystick/Joystick.cpp
tasks/Joystick/Joystick.h [code]Task that allow to command the robot with a the keyboard
tasks/KbHitTask/KbHitTask.cpp
tasks/KbHitTask/KbHitTask.h [code]
tasks/LaserNavigationTask/LaserNavigationTask.cpp
tasks/LaserNavigationTask/LaserNavigationTask.h [code]Laser Navigation task, to do
tasks/LineFollowing/LineFollowing.cpp
tasks/LineFollowing/LineFollowing.h [code]Task that allow to follow a line using ground sensors
tasks/Localization3D/Localization3D.cpp
tasks/Localization3D/Localization3D.h [code]Self localization task for 3D mobile robots
tasks/MutLocTask/MutLocTask.cpp
tasks/MutLocTask/MutLocTask.h [code]Mutual localization task
tasks/ObstacleAvoidance/ObstacleAvoidance.cpp
tasks/ObstacleAvoidance/ObstacleAvoidance.h [code]ObstacleAvoidance task: retrieve and set commands to control robot towards a goal
tasks/OfflinerTask/OfflinerTask.cpp
tasks/OfflinerTask/OfflinerTask.h [code]Task for the offline execution of other tasks. to do
tasks/ParticleMutLoc/ParticleMutLocTask.cpp
tasks/ParticleMutLoc/ParticleMutLocTask.h [code]Particle filter for Mutual localization task
tasks/ParticleMutLocCam/ParticleMutLocCamOffTask.cpp
tasks/ParticleMutLocCam/ParticleMutLocCamOffTask.h [code]Particle filter for Mutual localization task
tasks/ParticleMutLocCam/ParticleMutLocCamTask.cpp
tasks/ParticleMutLocCam/ParticleMutLocCamTask.h [code]Particle filter for Mutual localization task
tasks/ParticleMutLocNoMR/ParticleMutLocTaskNoMR.cpp
tasks/ParticleMutLocNoMR/ParticleMutLocTaskNoMR.h [code]Particle filter for Mutual localization task
tasks/PHDFilterTask/CentralizedPHDFilterTask.cpp
tasks/PHDFilterTask/CentralizedPHDFilterTask.h [code]PHDFilter task. to do
tasks/PHDFilterTask/PHDCamFilterTask.cpp
tasks/PHDFilterTask/PHDCamFilterTask.h [code]PHDCamFilter task. to do
tasks/PHDFilterTask/PHDFilterTask.cpp
tasks/PHDFilterTask/PHDFilterTask.h [code]PHDFilter task. to do
tasks/Pursuing/Pursuing.cpp
tasks/Pursuing/Pursuing.h [code]
tasks/Pursuing/PursuingMessages.h [code]
tasks/Pursuing/old_files_2009/Pursuing.cpp
tasks/Pursuing/old_files_2009/Pursuing.h [code]
tasks/Pursuing/old_files_2009/PursuingComm.cpp
tasks/Pursuing/old_files_2009/PursuingComm.h [code]Pursuing Task
tasks/Pursuing/old_files_2009/PursuingData.h [code]
tasks/Pursuing/pre_MutLoc/Pursuing.cpp
tasks/Pursuing/pre_MutLoc/Pursuing.h [code]
tasks/Pursuing/pre_MutLoc/PursuingMessages.h [code]
tasks/RemoteRobTask/RemoteRobTask.cpp
tasks/RemoteRobTask/RemoteRobTask.h [code]Remote Robot task
tasks/ScanMatching/ScanMatching.cpp
tasks/ScanMatching/ScanMatching.h [code]Localizes a robot using the scan matching
tasks/Task/Task.cpp
tasks/Task/Task.h [code]Abstract class for tasks
tasks/Task/TaskDict.h [code]Task dictionary
tasks/Task/TaskFactory.h [code]
tasks/Tracker/Tracker.cpp
tasks/Tracker/Tracker.h [code]Tracker task
tasks/UAV/UavHeightControl.cpp
tasks/UAV/UavHeightControl.h [code]Height control task
tasks/UAV/UavHeightControl_onboard.cpp
tasks/UAV/UavHeightControl_onboard.h [code]Height control task to test onboard height control
tasks/UAV/UavPositionControl.cpp
tasks/UAV/UavPositionControl.h [code]
tasks/UAVPositioningSystem/UAVPositioningSystem.cpp
tasks/UAVPositioningSystem/UAVPositioningSystem.h [code]UAVPositioningSystem task. to do
tasks/VisualHovering/VisualHovering.cpp
tasks/VisualHovering/VisualHovering.h [code]Task for Uav visual hovering on a specified target (Requires a Camera resource)

Generated on Mon Feb 20 07:01:14 2017 for MIP by  doxygen 1.5.6