►CArRobot | |
CvpRobotPioneer | Interface for Pioneer mobile robots based on Aria 3rd party library |
CClassUsingPclViewer | |
►Cstd::exception | |
►CvpException | Error that can be emitted by ViSP classes |
CvpCalibrationException | Error that can be emitted by the vpCalibration class |
CvpDisplayException | Error that can be emitted by the vpDisplay class and its derivatives |
CvpFeatureException | Error that can be emitted by the vpBasicFeature class and its derivates |
CvpFrameGrabberException | Error that can be emitted by the vpFrameGrabber class and its derivates |
CvpImageException | Error that can be emitted by the vpImage class and its derivatives |
CvpIoException | Error that can be emitted by the vpIoTools class and its derivatives |
CvpMatrixException | Error that can be emitted by the vpMatrix class and its derivatives |
CvpParallelPortException | Error that can be emitted by the vpParallelPort class and its derivates |
CvpPoseException | Error that can be emitted by the vpPose class and its derivatives |
CvpRobotException | Error that can be emitted by the vpRobot class and its derivatives |
CvpServoException | Error that can be emitted by the vpServo class and its derivatives |
CvpTrackingException | Error that can be emitted by the vpTracker class and its derivatives |
►COgre::FrameListener | |
CvpAROgre | Implementation of an augmented reality viewer using Ogre3D 3rd party |
►CFreenect::FreenectDevice | |
CvpKinect | Driver for the Kinect-1 device |
CvpDisplayFactory::impl::GridSettings | |
CvpReflexTakktile2::HandInfo | |
CImageDisplay(withContext) | |
►COIS::KeyListener | |
CvpAROgre | Implementation of an augmented reality viewer using Ogre3D 3rd party |
CvpPclViewer::legendParams | Structure that contains all the required parameters to display a legend on the viewer |
Cvisp::cnpy::NpyArray | |
CSoftwareArguments | [Markers_class] |
►CSoWinExaminerViewer | |
CvpViewer | Viewer used by the simulator |
CvpACSimulator | Class to simulate a flying aircraft |
CvpAdaptiveGain | Adaptive gain computation |
►CvpAfma4 | Modelization of Irisa's cylindrical robot named Afma4 |
CvpRobotAfma4 | Control of Irisa's cylindrical robot named Afma4 |
►CvpAfma6 | Modelization of Irisa's gantry robot named Afma6 |
CvpRobotAfma6 | Control of Irisa's gantry robot named Afma6 |
CvpArray2D< Type > | Implementation of a generic 2D array used as base class for matrices and vectors |
►CvpArray2D< double > | |
►CvpColVector | Implementation of column vector and the associated operations |
CvpSubColVector | |
CvpForceTwistMatrix | |
CvpHomogeneousMatrix | Implementation of an homogeneous matrix and operations on such kind of matrices |
CvpHomography | Implementation of an homography and operations on homographies |
►CvpMatrix | Implementation of a matrix and operations on matrices |
CvpSubMatrix | Definition of the vpSubMatrix class that provides a mask on a vpMatrix. All properties of vpMatrix are available with a vpSubMatrix |
CvpPoseVector | Implementation of a pose vector and operations on poses |
CvpRotationMatrix | Implementation of a rotation matrix and operations on such kind of matrices |
►CvpRotationVector | Implementation of a generic rotation vector |
CvpQuaternionVector | Implementation of a rotation vector as quaternion angle minimal representation |
CvpRxyzVector | Implementation of a rotation vector as Euler angle minimal representation |
CvpRzyxVector | Implementation of a rotation vector as Euler angle minimal representation |
CvpRzyzVector | Implementation of a rotation vector as Euler angle minimal representation |
CvpThetaUVector | Implementation of a rotation vector as axis-angle minimal representation |
►CvpRowVector | Implementation of row vector and the associated operations |
CvpSubRowVector | |
CvpTranslationVector | Class that consider the case of a translation vector |
CvpVelocityTwistMatrix | |
CvpArray2D< float > | |
►CvpBasicFeature | Class that defines what is a visual feature |
CvpFeatureDepth | Class that defines a 3D point visual feature which is composed by one parameters that is that defines the current depth relative to the desired depth. Here represents the current depth and the desired depth |
CvpFeatureEllipse | Class that defines 2D ellipse visual feature |
CvpFeatureLine | Class that defines a 2D line visual feature which is composed by two parameters that are and , the polar coordinates of a line |
CvpFeatureLuminance | Class that defines the image luminance visual feature |
CvpFeatureLuminanceMapping | Class to combine luminance features (photometric servoing) |
►CvpFeatureMoment | This class defines shared system methods/attributes for 2D moment features but no functional code. It is used to compute interaction matrices for moment features |
CvpFeatureMomentAlpha | Functionality computation for in-plane rotation moment feature : computes the interaction matrix associated with vpMomentAlpha |
CvpFeatureMomentArea | Surface moment feature. Computes the interaction matrix associated with vpMomentArea |
CvpFeatureMomentAreaNormalized | Functionality computation for normalized surface moment feature. Computes the interaction matrix associated with vpMomentAreaNormalized |
CvpFeatureMomentBasic | Functionality computation for basic moment feature. Computes the interaction matrix associated with vpMomentBasic |
CvpFeatureMomentCInvariant | Functionality computation for 2D rotation/translation/scale non-symmetric invariant moment feature. Computes the interaction matrix associated with vpMomentCInvariant |
CvpFeatureMomentCentered | Functionality computation for centered moment feature. Computes the interaction matrix associated with vpMomentCentered |
CvpFeatureMomentGravityCenter | Functionality computation for gravity center moment feature. Computes the interaction matrix associated with vpMomentGravityCenter |
CvpFeatureMomentGravityCenterNormalized | Functionality computation for centered and normalized moment feature. Computes the interaction matrix associated with vpMomentGravityCenterNormalized |
CvpMomentGenericFeature | This class defines a generic feature used for moment feature duplication |
CvpFeaturePoint | Class that defines a 2D point visual feature which is composed by two parameters that are the cartesian coordinates and |
CvpFeaturePoint3D | Class that defines the 3D point visual feature |
CvpFeaturePointPolar | Class that defines 2D image point visual feature with polar coordinates described in [10] |
CvpFeatureSegment | Class that defines a 2D segment visual features. This class allow to consider two sets of visual features: |
CvpFeatureThetaU | Class that defines a 3D visual feature from a axis/angle parametrization that represent the rotation between to frames |
CvpFeatureTranslation | Class that defines the translation visual feature |
CvpFeatureVanishingPoint | |
CvpGenericFeature | Class that enables to define a feature or a set of features which are not implemented in ViSP as a specific class. It is indeed possible to create its own features, to use the corresponding interaction matrix, and to compute an error between the current and the desired feature. Moreover the created features can be mixed with features already implemented |
►CvpBasicKeyPoint | Class that defines what is a keypoint. This class provides all the basic elements to implement classes which aims to match points from an image to another |
CvpKeyPoint | Class that allows keypoints detection (and descriptors extraction) and matching thanks to OpenCV library. Thus to enable this class OpenCV should be installed. Installation instructions are provided here https://visp.inria.fr/3rd_opencv |
►CvpBiclops | Jacobian, geometric model functionalities... for Biclops, pan, tilt head |
CvpRobotBiclops | Interface for the Biclops, pan, tilt head control |
CvpBicycleModel | Class that approximates a 4-wheel robot using a bicycle model |
►CvpBSpline | Class that provides tools to compute and manipulate a B-Spline curve |
CvpNurbs | Class that provides tools to compute and manipulate a Non Uniform Rational B-Spline curve |
CvpCalibration | Tools for perspective camera calibration |
CvpCameraParameters | Generic class defining intrinsic camera parameters |
CvpCannyEdgeDetection | Class that implements the Canny's edge detector. It is possible to use a boolean mask to ignore some pixels of the input gray-scale image |
CvpChrono | |
CvpCircleHoughTransform | Class that permits to detect 2D circles in a image using the gradient-based Circle Hough transform. Please find more information on the algorithm here |
CvpCircleHoughTransform::vpCircleHoughTransformParams | Class that gather the algorithm parameters |
CvpColorBlindFriendlyPalette | Class that furnishes a set of colors that color blind people should be able to distinguish one from another |
CvpColorDepthConversion | |
CvpColormap | Creates a colormap class to be able to recolor an image with different grayscale values into some corresponding color values, for better visualization for example |
►CvpComedi | |
CvpForceTorqueAtiSensor | |
CVISP_NAMESPACE_NAME::vpContour | |
CvpConvert | |
►CvpDetectorBase | |
CvpDetectorAprilTag | |
CvpDetectorDataMatrixCode | |
CvpDetectorFace | |
CVISP_NAMESPACE_NAME::vpDirection | |
►CvpDisplay | Class that defines generic functionalities for display |
CvpDisplayGTK | The vpDisplayGTK allows to display image using the GTK 3rd party library. Thus to enable this class GTK should be installed. Installation instructions are provided here https://visp.inria.fr/3rd_gtk |
CvpDisplayOpenCV | The vpDisplayOpenCV allows to display image using the OpenCV library. Thus to enable this class OpenCV should be installed. Installation instructions are provided here https://visp.inria.fr/3rd_opencv |
►CvpDisplayWin32 | Base abstract class for Windows 32 displays. Implements the window creation in a separate thread and the associated event handling functions for Windows 32 displays. Uses calls to a renderer to do some display. (i.e. all display methods are implemented in the renderer) |
CvpDisplayD3D | Display for windows using Direct3D 3rd party. Thus to enable this class Direct3D should be installed. Installation instructions are provided here https://visp.inria.fr/3rd_d3d/ |
CvpDisplayGDI | Display for windows using GDI (available on any windows 32 platform) |
CvpDisplayPCL | |
CvpExponentialMap | Direct or inverse exponential map computation |
CvpFeatureBuilder | Class that defines conversion between trackers and visual features |
CvpFeatureDisplay | Interface with the image for feature display |
►CvpFeatureMomentDatabase | This class allows to register all feature moments (implemented in vpFeatureMoment... classes) so they can access each other according to their dependencies |
CvpFeatureMomentCommon | This class allows to access common vpFeatureMoments in a pre-filled database |
CvpFont | Font drawing functions for image |
CvpForceTorqueIitSensor | |
►CvpFrameGrabber | Base class for all video devices. It is designed to provide a front end to video sources |
Cvp1394CMUGrabber | Firewire cameras video capture based on CMU 1394 Digital Camera SDK |
Cvp1394TwoGrabber | Class for firewire ieee1394 video devices using libdc1394-2.x api |
CvpDirectShowGrabber | Class for windows direct show devices |
CvpDiskGrabber | Class to grab (ie. read) images from the disk |
CvpFlyCaptureGrabber | |
►CvpPylonGrabber | |
CvpPylonGrabberGigE | |
CvpPylonGrabberUsb | |
CvpV4l2Grabber | Class that is a wrapper over the Video4Linux2 (V4L2) driver |
CvpVideoReader | Class that enables to manipulate easily a video file or a sequence of images. As it inherits from the vpFrameGrabber Class, it can be used like an other frame grabber class |
CvpGaussianFilter | Gaussian filter class |
CvpGaussRand | Class for generating random number with normal probability density |
CvpHandEyeCalibration | Tool for hand-eye calibration |
CvpHistogram | Class to compute a gray level image histogram |
►CvpHistogramPeak | Declaration of the peak (maximum value) in a gray level image histogram |
CvpHistogramValey | Declaration of the valey (minimum value) in a gray level image histogram |
CvpImage< Type > | Definition of the vpImage class member functions |
CvpImage< bool > | |
CvpImage< double > | |
CvpImage< float > | |
CvpImage< unsigned char > | |
CvpImage< vpRGBa > | |
CvpImageCircle | Class that defines a 2D circle in an image |
CvpImageConvert | |
CvpImageDraw | Drawing functions for image |
CvpImageFilter | Various image filter, convolution, etc.. |
CvpImageIo | Read/write images with various image format |
CvpImageMorphology | Various mathematical morphology tools, erosion, dilatation.. |
CvpImagePoint | Class that defines a 2D point in an image. This class is useful for image processing and stores only the 2D coordinates given in sub-pixel |
CvpImageSimulator | Class which enables to project an image in the 3D space and get the view of a virtual camera |
CvpImageStorageWorker< Type > | |
CvpImageTools | Various image tools; sub-image extraction, modification of the look up table, binarisation.. |
CvpIoTools | File and directories basic tools |
CvpJsonArgumentParser | Command line argument parsing with support for JSON files. If a JSON file is supplied, it is parsed and command line arguments take precedence over values given in the file |
►CvpKalmanFilter | This class provides a generic Kalman filtering algorithm along with some specific state model (constant velocity, constant acceleration) which are implemented in the vpLinearKalmanFilterInstantiation class |
CvpLinearKalmanFilterInstantiation | This class provides an implementation of some specific linear Kalman filters |
CvpKeyboard | Keyboard management under unix (Linux or OSX). This class is not available under windows |
CvpKltOpencv | Wrapper for the KLT (Kanade-Lucas-Tomasi) feature tracker implemented in OpenCV. Thus to enable this class OpenCV should be installed. Installation instructions are provided here https://visp.inria.fr/3rd_opencv |
CvpLandmarkMeasurements | Class that permits to convert the position + heading of the 4-wheel robot into measurements from a landmark |
CvpLandmarksGrid | Class that represent a grid of landmarks that measure the distance and relative orientation of the 4-wheel robot |
CvpLaserScan | Implements a laser scan data structure that contains especially the list of scanned points that have been recorded for this laser scan |
CvpLaserScanner | Class that defines a generic laser scanner |
CvpLinProg | This class provides two solvers for Linear Programs |
CvpList< type > | Provide simple list management |
►CvpLuminanceMapping | Base class for functions that map an image and its interaction matrix to a different domain |
CvpLuminanceDCT | Implementation of [36] |
CvpLuminancePCA | Implementation of [35] |
CvpMarkersMeasurements | [Object_simulator] |
CvpMath | Provides simple mathematics computation tools that are not available in the C mathematics library (math.h) |
CvpLuminanceDCT::vpMatrixZigZagIndex | Helper class to iterate and get/set the values from a matrix, following a zigzag pattern |
CvpMbHiddenFaces< PolygonType > | Implementation of the polygons management for the model-based trackers |
CvpMbHiddenFaces< vpMbtPolygon > | |
CvpMbtDistanceCircle | Manage a circle used in the model-based tracker |
CvpMbtDistanceCylinder | Manage a cylinder used in the model-based tracker |
CvpMbtDistanceLine | Manage the line of a polygon used in the model-based tracker |
CvpMbtFaceDepthDense | |
CvpMbtFaceDepthNormal | |
►CvpMbTracker | Main methods for a model-based tracker |
CvpMbDepthDenseTracker | |
CvpMbDepthNormalTracker | |
CvpMbEdgeTracker | Make the complete tracking of an object by using its CAD model |
CvpMbGenericTracker | Real-time 6D object pose tracking using its CAD model |
CvpMbtXmlGenericParser | Parse an Xml file to extract configuration parameters of a mbtConfig object |
CvpMe | |
CvpMegaPose | |
CvpMegaPoseEstimate | |
CvpMegaPoseTracker | A simplified interface to track a single object with MegaPose. This tracker works asynchronously: A call to init or track will not stop the current thread. Rather, an std::future object is returned, and its result should be acquired when it is ready |
CvpMeSite | Performs search in a given direction(normal) for a given distance(pixels) for a given 'site'. Gives the most likely site given the probability from an ME mask |
CvpMeterPixelConversion | |
►CvpMocap | |
CvpMocapQualisys | |
CvpMocapVicon | |
►CvpMoment | This class defines shared methods/attributes for 2D moments |
CvpMomentAlpha | This class defines the orientation of the object inside the plane parallel to the object |
CvpMomentArea | Class handling the surface moment |
CvpMomentAreaNormalized | Class handling the normalized surface moment that is invariant in scale and used to estimate depth |
CvpMomentBasic | This class defines the 2D basic moment . This class is a wrapper for vpMomentObject which allows to use it as a moment. This enables all common operations such as adding to a vpMomentDatabase |
CvpMomentCInvariant | |
CvpMomentCentered | This class defines the double-indexed centered moment descriptor |
►CvpMomentGravityCenter | Class describing 2D gravity center moment |
CvpMomentGravityCenterNormalized | Class describing 2D normalized gravity center moment |
►CvpMomentDatabase | This class allows to register all vpMoments so they can access each other according to their dependencies |
CvpMomentCommon | This class initializes and allows access to commonly used moments |
CvpMomentObject | Class for generic objects |
CvpMouseButton | Class that defines mouse button identifiers |
►CvpNetwork | This class represents a Transmission Control Protocol (TCP) network |
CvpClient | This class represents a Transmission Control Protocol (TCP) client |
CvpServer | This class represents a Transmission Control Protocol (TCP) server |
CvpObjectSimulator | [Process_function] |
CvpOccipitalStructure | |
►CvpPanda3DBaseRenderer | Base class for a panda3D renderer. This class handles basic functionalities, such as loading object, changing camera parameters |
CvpPanda3DGeometryRenderer | Renderer that outputs object geometric information |
►CvpPanda3DPostProcessFilter | Base class for postprocessing filters that map the result of a vpPanda3DBaseRenderer to a new image |
CvpPanda3DCanny | Implementation of canny filtering, using Sobel kernels |
CvpPanda3DGaussianBlur | Class that implements a gaussian filter on a grayscale image. The grayscale image should be contained in the blue channel of the image |
CvpPanda3DLuminanceFilter | Class that implements an RGB to grayscale conversion |
CvpPanda3DRGBRenderer | Implementation of a traditional RGB renderer in Panda3D |
CvpPanda3DRendererSet | Class that rendering multiple datatypes, in a single pass. A RendererSet contains multiple subrenderers, all inheriting from vpPanda3DBaseRenderer. The renderer set synchronizes all scene properties for the different subrenderers. This includes: |
►CvpPanda3DLight | Base class for a Light that can be added to a Panda3D scene |
CvpPanda3DAmbientLight | Class representing an ambient light |
CvpPanda3DDirectionalLight | Class representing a directional light |
CvpPanda3DPointLight | Class representing a Point Light |
►CvpPanda3DLightable | Interface for objects, scenes or other Panda3D related data that can be lit by a vpPanda3DLight |
►CvpPanda3DLightableScene | Implementation of vpPanda3DLightable for a panda scene with a root node |
CvpPanda3DRGBRenderer | Implementation of a traditional RGB renderer in Panda3D |
CvpPanda3DRendererSet | Class that rendering multiple datatypes, in a single pass. A RendererSet contains multiple subrenderers, all inheriting from vpPanda3DBaseRenderer. The renderer set synchronizes all scene properties for the different subrenderers. This includes: |
CvpPanda3DRenderParameters | Rendering parameters for a panda3D simulation |
CvpParallelPort | Parallel port management under unix |
CvpParseArgv | Command line argument parsing |
CvpParticleFilter< MeasurementsType > | The class permits to use a Particle Filter |
CvpParticleFilter< MeasurementsType >::vpParticlesWithWeights | Structure of vectors for which the i^th element of the weights vector is associated to the i^th element of the particles vectors |
CvpPclViewer | |
CvpPixelMeterConversion | |
CvpPlane | This class defines the container for a plane geometrical structure |
CvpPlot | This class enables real time drawing of 2D or 3D graphics. An instance of the class open a window which contains between 1 and 4 graphics. Each one contains a desired number of curves |
CvpPololu | Interface for the Pololu Maestro USB Servo Controllers |
CvpPolygon | Defines a generic 2D polygon |
►CvpPolygon3D | Implements a 3D polygon with render functionalities like clipping |
CvpMbtPolygon | Implementation of a polygon of the model used by the model-based tracker |
CvpPose | Class used for pose computation from N points (pose from point only). Some of the algorithms implemented in this class are described in [34] |
CvpProcessFunctor | As the state model {x, y, } does not contain any velocity information, it does not evolve without commands. Thus, we create a functor that will save the current command to use it in the process function to project a particle in time |
CvpProjectionDisplay | Interface with the image for feature display |
►CvpPtu46 | Jacobian, geometric model functionalities... for ptu46, pan, tilt head from Directed Perception |
CvpRobotPtu46 | Interface for the Directed Perception ptu-46 pan, tilt head |
CvpPylonFactory | Factory singleton class to create vpPylonGrabber subclass instances |
►CvpQbDevice | |
CvpQbSoftHand | |
CvpQuadProg | This class provides a solver for Quadratic Programs |
CvpRadarStation | Class that permits to convert the position of the aircraft into range and elevation angle measurements |
CvpRansac< vpTransformation > | This class is a generic implementation of the Ransac algorithm. It cannot be used alone |
CvpRealSense | |
CvpRealSense2 | |
CvpRect | Defines a rectangle in the plane |
CvpRectOriented | Defines an oriented rectangle in the plane |
CvpReflexTakktile2 | |
CvpRequest | This the request that will transit on the network |
►CvpRGBa | |
CvpColor | Class to define RGB colors available for display functionalities |
CvpRGBf | |
►CvpRobot | Class that defines a generic virtual robot |
CvpRobotAfma4 | Control of Irisa's cylindrical robot named Afma4 |
CvpRobotAfma6 | Control of Irisa's gantry robot named Afma6 |
CvpRobotBiclops | Interface for the Biclops, pan, tilt head control |
CvpRobotFlirPtu | |
CvpRobotFranka | |
CvpRobotKinova | |
CvpRobotPioneer | Interface for Pioneer mobile robots based on Aria 3rd party library |
CvpRobotPololuPtu | Interface for the Pololu Maestro pan-tilt unit using two servo motors |
CvpRobotPtu46 | Interface for the Directed Perception ptu-46 pan, tilt head |
►CvpRobotSimulator | This class aims to be a basis used to create all the robot simulators |
CvpSimulatorCamera | Class that defines the simplest robot: a free flying camera |
CvpSimulatorPioneer | Class that defines the Pioneer mobile robot simulator equipped with a static camera |
CvpSimulatorPioneerPan | Class that defines the Pioneer mobile robot simulator equipped with a camera able to move in pan |
CvpRobotTemplate | Class that defines a robot just to show which function you must implement |
CvpRobotUniversalRobots | |
CvpRobotViper650 | Control of Irisa's Viper S650 robot named Viper650 |
CvpRobotViper850 | Control of Irisa's Viper S850 robot named Viper850 |
CvpRobotBebop2 | |
CvpRobust | Contains an M-estimator and various influence function |
CvpRealSense::vpRsStreamParams | |
CvpScale | Contains various estimators for scale.
Methods : Median Absolute Deviation (MAD), MPDE, Mean shift kernel density estimation |
CvpScanPoint | Class that defines a single laser scanner point |
CvpSerial | |
CvpServo | |
CvpServoData | Save data during the task execution when using vpServo |
CvpServoDisplay | Interface with the image for feature display |
CvpUKSigmaDrawerAbstract::vpSigmaPointsWeights | The weights corresponding to the sigma points drawing |
►CvpSimulator | Implementation of a simulator based on Coin3d (www.coin3d.org) |
CvpAR | Implementation of an augmented reality viewer using Coin3D 3rd party |
►CvpStatisticalTestAbstract | Base class for methods detecting the drift of the mean of a process |
CvpStatisticalTestEWMA | Class that permits to perform Exponentially Weighted Moving Average mean drft tests |
CvpStatisticalTestHinkley | This class implements the Hinkley's cumulative sum test |
CvpStatisticalTestMeanAdjustedCUSUM | Class that permits to perform a mean adjusted Cumulative Sum test |
►CvpStatisticalTestSigma | Class that permits a simple test comparing the current value to the standard deviation of the signal |
CvpStatisticalTestShewhart | Class that permits a Shewhart's test |
►CvpTemplateTracker | |
►CvpTemplateTrackerMI | |
CvpTemplateTrackerMIESM | |
CvpTemplateTrackerMIForwardAdditional | |
CvpTemplateTrackerMIForwardCompositional | |
CvpTemplateTrackerMIInverseCompositional | |
►CvpTemplateTrackerSSD | |
CvpTemplateTrackerSSDESM | |
CvpTemplateTrackerSSDForwardAdditional | |
CvpTemplateTrackerSSDForwardCompositional | |
CvpTemplateTrackerSSDInverseCompositional | |
►CvpTemplateTrackerZNCC | |
CvpTemplateTrackerZNCCForwardAdditional | |
CvpTemplateTrackerZNCCInverseCompositional | |
CvpTemplateTrackerDPoint | |
CvpTemplateTrackerPoint | |
CvpTemplateTrackerPointCompo | |
CvpTemplateTrackerTriangle | |
►CvpTemplateTrackerWarp | |
CvpTemplateTrackerWarpAffine | |
CvpTemplateTrackerWarpHomography | |
CvpTemplateTrackerWarpHomographySL3 | |
CvpTemplateTrackerWarpRT | |
CvpTemplateTrackerWarpSRT | |
CvpTemplateTrackerWarpTranslation | |
CvpTemplateTrackerZone | |
CvpTemplateTrackerZPoint | |
CvpTraceOutput | This class is used to display debug or error messages |
►CvpTracker | Class that defines what is a feature generic tracker |
CvpDot | This tracker is meant to track a dot (connected pixels with same gray level) on a vpImage |
CvpDot2 | This tracker is meant to track a blob (connex pixels with same gray level) on a vpImage |
►CvpForwardProjection | Class that defines what is a generic geometric feature |
CvpCircle | Class that defines a 3D circle in the object frame and allows forward projection of a 3D circle in the camera frame and in the 2D image plane by perspective projection. All the parameters must be set in meter |
CvpCylinder | Class that defines a 3D cylinder in the object frame and allows forward projection of a 3D cylinder in the camera frame and in the 2D image plane by perspective projection. All the parameters must be set in meter |
CvpLine | Class that defines a 3D line in the object frame and allows forward projection of the line in the camera frame and in the 2D image plane by perspective projection. All the parameters must be set in meter |
CvpPoint | Class that defines a 3D point in the object frame and allows forward projection of a 3D point in the camera frame and in the 2D image plane by perspective projection. All the parameters must be set in meter |
CvpSphere | Class that defines a 3D sphere in the object frame and allows forward projection of a 3D sphere in the camera frame and in the 2D image plane by perspective projection. All the parameters must be set in meter |
►CvpMeTracker | Contains abstract elements for a Distance to Feature type feature |
CvpMeEllipse | Class that tracks an ellipse using moving edges |
CvpMeLine | Class that tracks in an image a line moving edges |
CvpMeNurbs | Class that tracks in an image a edge defined by a Nurbs |
CvpTriangle | Defines a 2D triangle |
►CvpUDPClient | This class implements a basic (IPv4) User Datagram Protocol (UDP) client |
CvpForceTorqueAtiNetFTSensor | |
CvpUDPServer | This class implements a basic (IPv4) User Datagram Protocol (UDP) server |
CvpUeyeGrabber | |
►CvpUKSigmaDrawerAbstract | |
CvpUKSigmaDrawerMerwe | |
►CvpUnicycle | Generic functions for unicycle mobile robots |
►CvpPioneer | Generic functions for Pioneer mobile robots |
CvpRobotPioneer | Interface for Pioneer mobile robots based on Aria 3rd party library |
CvpSimulatorPioneer | Class that defines the Pioneer mobile robot simulator equipped with a static camera |
►CvpPioneerPan | Generic functions for Pioneer mobile robots equipped with a pan head |
CvpSimulatorPioneerPan | Class that defines the Pioneer mobile robot simulator equipped with a camera able to move in pan |
CvpUniRand | Class for generating random numbers with uniform probability density |
CvpUnscentedKalman | |
CvpVideoWriter | Class that enables to write easily a video file or a sequence of images |
►CvpViper | Modelization of the ADEPT Viper robot |
►CvpViper650 | Modelization of the ADEPT Viper 650 robot |
CvpRobotViper650 | Control of Irisa's Viper S650 robot named Viper650 |
►CvpViper850 | Modelization of the ADEPT Viper 850 robot |
CvpRobotViper850 | Control of Irisa's Viper S850 robot named Viper850 |
CvpVirtualGrabber | |
CvpVirtuose | |
CvpWireFrameSimulator | Implementation of a wire frame simulator. Compared to the vpSimulator class, it does not require third party libraries to be used |
CvpXmlConfigParserKeyPoint | |
CvpXmlParserCamera | XML parser to load and save intrinsic camera parameters |
CvpXmlParserHomogeneousMatrix | XML parser to load and save an homogeneous matrix in a file |
CvpXmlParserRectOriented | XML parser to load and save an oriented rectangle in a file |
►COgre::WindowEventListener | |
CvpAROgre | Implementation of an augmented reality viewer using Ogre3D 3rd party |