Visual Servoing Platform
version 3.6.1 under development (2025-01-11)
|
►Nvisp | |
►NVISP_NAMESPACE_NAME | |
►NvpDisplayFactory | |
CClassUsingPclViewer | |
CCmdArguments | |
CFastMat33 | |
CFastMat63 | |
CFastVec3 | |
CImageDisplay(withContext) | |
CSoftwareArguments | [Markers_class] |
CTrajectoryData | |
Cvp1394CMUGrabber | Firewire cameras video capture based on CMU 1394 Digital Camera SDK |
Cvp1394TwoGrabber | Class for firewire ieee1394 video devices using libdc1394-2.x api |
CvpACSimulator | Class to simulate a flying aircraft |
CvpAdaptiveGain | Adaptive gain computation |
CvpAfma4 | Modelization of Irisa's cylindrical robot named Afma4 |
CvpAfma6 | Modelization of Irisa's gantry robot named Afma6 |
CvpAR | Implementation of an augmented reality viewer using Coin3D 3rd party |
CvpAROgre | Implementation of an augmented reality viewer using Ogre3D 3rd party |
CvpArray2D | Implementation of a generic 2D array used as base class for matrices and vectors |
CvpBasicFeature | Class that defines what is a visual feature |
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 |
CvpBiclops | Jacobian, geometric model functionalities... for Biclops, pan, tilt head |
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 |
CvpCalibration | Tools for perspective camera calibration |
CvpCalibrationException | Error that can be emitted by the vpCalibration class |
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 |
CvpCCDParameters | |
CvpCCDStatistics | |
CvpChrono | |
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 |
►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 |
CvpClient | This class represents a Transmission Control Protocol (TCP) client |
CvpColor | Class to define RGB colors available for display functionalities |
CvpColorBlindFriendlyPalette | Class that furnishes a set of colors that color blind people should be able to distinguish one from another |
CvpColorDepthConversion | |
►CvpColorHistogram | |
CvpColorHistogramMask | A color histogram based segmentation algorithm |
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 |
CvpColVector | Implementation of column vector and the associated operations |
CvpComedi | |
CvpConvert | |
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 |
CvpDetectorAprilTag | |
CvpDetectorBase | |
CvpDetectorDataMatrixCode | |
CvpDetectorFace | |
CvpDirectShowGrabber | Class for windows direct show devices |
CvpDiskGrabber | Class to grab (ie. read) images from the disk |
CvpDisplay | Class that defines generic functionalities for display |
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/ |
CvpDisplayException | Error that can be emitted by the vpDisplay class and its derivatives |
CvpDisplayGDI | Display for windows using GDI (available on any windows 32 platform) |
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 |
CvpDisplayPCL | |
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) |
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 |
CvpDynamicFactory | |
CvpException | Error that can be emitted by ViSP classes |
CvpExponentialMap | Direct or inverse exponential map computation |
CvpFeatureBuilder | Class that defines conversion between trackers and visual features |
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 |
CvpFeatureDisplay | Interface with the image for feature display |
CvpFeatureEllipse | Class that defines 2D ellipse visual feature |
CvpFeatureException | Error that can be emitted by the vpBasicFeature class and its derivates |
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 |
CvpFeatureMomentCentered | Functionality computation for centered moment feature. Computes the interaction matrix associated with vpMomentCentered |
CvpFeatureMomentCInvariant | Functionality computation for 2D rotation/translation/scale non-symmetric invariant moment feature. Computes the interaction matrix associated with vpMomentCInvariant |
CvpFeatureMomentCommon | This class allows to access common vpFeatureMoments in a pre-filled database |
CvpFeatureMomentDatabase | This class allows to register all feature moments (implemented in vpFeatureMoment... classes) so they can access each other according to their dependencies |
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 |
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 | |
CvpFlyCaptureGrabber | |
CvpFont | Font drawing functions for image |
CvpForceTorqueAtiNetFTSensor | |
CvpForceTorqueAtiSensor | |
CvpForceTorqueIitSensor | |
CvpForceTwistMatrix | |
CvpForwardProjection | Class that defines what is a generic geometric feature |
CvpFrameGrabber | Base class for all video devices. It is designed to provide a front end to video sources |
CvpFrameGrabberException | Error that can be emitted by the vpFrameGrabber class and its derivates |
CvpGaussianFilter | Gaussian filter class |
CvpGaussRand | Class for generating random number with normal probability density |
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 |
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 |
CvpHomogeneousMatrix | Implementation of an homogeneous matrix and operations on such kind of matrices |
CvpHomography | Implementation of an homography and operations on homographies |
CvpImage | Definition of the vpImage class member functions |
CvpImageCircle | Class that defines a 2D circle in an image |
CvpImageConvert | |
CvpImageDraw | Drawing functions for image |
CvpImageException | Error that can be emitted by the vpImage class and its derivatives |
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 | |
CvpImageTools | Various image tools; sub-image extraction, modification of the look up table, binarisation.. |
CvpIoException | Error that can be emitted by the vpIoTools class and its derivatives |
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 |
CvpKeyboard | Keyboard management under unix (Linux or OSX). This class is not available under windows |
CvpKeyPoint | Class that allows keypoints 2D features 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 |
CvpKinect | Driver for the Kinect-1 device |
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 |
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 |
CvpLinearKalmanFilterInstantiation | This class provides an implementation of some specific linear Kalman filters |
CvpLinProg | This class provides two solvers for Linear Programs |
CvpList | Provide simple list management |
►CvpLuminanceDCT | Implementation of [36] |
CvpLuminanceMapping | Base class for functions that map an image and its interaction matrix to a different domain |
CvpLuminancePCA | Implementation of [35] |
CvpMarkersMeasurements | [Object_simulator] |
CvpMath | Provides simple mathematics computation tools that are not available in the C mathematics library (math.h) |
CvpMatrix | Implementation of a matrix and operations on matrices |
CvpMatrixException | Error that can be emitted by the vpMatrix class and its derivatives |
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 |
CvpMbHiddenFaces | Implementation of the polygons management for the model-based trackers |
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 | |
CvpMbtPolygon | Implementation of a polygon of the model used by the model-based tracker |
CvpMbTracker | Main methods for a model-based tracker |
CvpMbtXmlGenericParser | Parse an Xml file to extract configuration parameters of a mbtConfig object |
CvpMe | |
CvpMeEllipse | Class that tracks an ellipse using moving edges |
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 |
CvpMeLine | Class that tracks in an image a line moving edges |
CvpMeNurbs | Class that tracks in an image a edge defined by a Nurbs |
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 | |
CvpMeTracker | Contains abstract elements for a Distance to Feature type feature |
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 |
CvpMomentCentered | This class defines the double-indexed centered moment descriptor |
CvpMomentCInvariant | |
CvpMomentCommon | This class initializes and allows access to commonly used moments |
CvpMomentDatabase | This class allows to register all vpMoments so they can access each other according to their dependencies |
CvpMomentGenericFeature | This class defines a generic feature used for moment feature duplication |
CvpMomentGravityCenter | Class describing 2D gravity center moment |
CvpMomentGravityCenterNormalized | Class describing 2D normalized gravity center moment |
CvpMomentObject | Class for generic objects |
CvpMouseButton | Class that defines mouse button identifiers |
CvpNetwork | This class represents a Transmission Control Protocol (TCP) network |
CvpNurbs | Class that provides tools to compute and manipulate a Non Uniform Rational B-Spline curve |
CvpObjectCentricRenderer | Single object focused renderer |
CvpObjectMask | |
CvpObjectMaskFactory | A factory that can be used to create Object segmentation algorithms from JSON data |
CvpObjectSimulator | [Process_function] |
CvpOccipitalStructure | |
CvpPanda3DAmbientLight | Class representing an ambient light |
CvpPanda3DBaseRenderer | Base class for a panda3D renderer. This class handles basic functionalities, such as loading object, changing camera parameters |
CvpPanda3DCanny | Implementation of canny filtering, using Sobel kernels |
CvpPanda3DDepthCannyFilter | Implementation of canny filtering, using Sobel kernels |
CvpPanda3DDepthGaussianBlur | |
CvpPanda3DDirectionalLight | Class representing a directional light |
CvpPanda3DGaussianBlur | Class that implements a gaussian filter on a grayscale image. The grayscale image should be contained in the blue channel of the image |
CvpPanda3DGeometryRenderer | Renderer that outputs object geometric information |
CvpPanda3DLight | Base class for a Light that can be added to a Panda3D scene |
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 |
CvpPanda3DLuminanceFilter | Class that implements an RGB to grayscale conversion |
CvpPanda3DPointLight | Class representing a Point Light |
CvpPanda3DPostProcessFilter | Base class for postprocessing filters that map the result of a vpPanda3DBaseRenderer to a new image |
CvpPanda3DRendererSet | Class that renders multiple datatypes, in a single pass. A renderer set 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 |
CvpPanda3DRGBRenderer | Implementation of a traditional RGB renderer in Panda3D |
CvpParallelPort | Parallel port management under unix |
CvpParallelPortException | Error that can be emitted by the vpParallelPort class and its derivates |
CvpParseArgv | Command line argument parsing |
►CvpParticleFilter | The class permits to use a Particle Filter |
►CvpPclViewer | |
CvpPioneer | Generic functions for Pioneer mobile robots |
CvpPioneerPan | Generic functions for Pioneer mobile robots equipped with a pan head |
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 |
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 |
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 |
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] |
CvpPoseException | Error that can be emitted by the vpPose class and its derivatives |
CvpPoseVector | Implementation of a pose vector and operations on poses |
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 |
CvpPylonFactory | Factory singleton class to create vpPylonGrabber subclass instances |
CvpPylonGrabber | |
CvpPylonGrabberGigE | |
CvpPylonGrabberUsb | |
CvpQbDevice | |
CvpQbSoftHand | |
CvpQuadProg | This class provides a solver for Quadratic Programs |
CvpQuaternionVector | Implementation of a rotation vector as quaternion angle minimal representation |
CvpRadarStation | Class that permits to convert the position of the aircraft into range and elevation angle measurements |
CvpRansac | This class is a generic implementation of the Ransac algorithm. It cannot be used alone |
►CvpRBDenseDepthTracker | A tracker based on dense depth point-plane alignment |
CvpRBDriftDetector | Base interface for algorithms that should detect tracking drift for the render-based tracker |
CvpRBDriftDetectorFactory | A factory that can be used to instanciate drift detection algorithms from JSON data |
CvpRBFeatureTracker | A base class for all features that can be used and tracked in the vpRBTracker |
CvpRBFeatureTrackerFactory | A factory to instantiate feature trackers from JSON data |
CvpRBFeatureTrackerInput | All the data related to a single tracking frame. This contains both the input data (from a real camera/outside source) and renders from Panda |
CvpRBInitializationHelper | A set of utilities to perform initialization |
CvpRBProbabilistic3DDriftDetector | Algorithm that uses tracks object surface points in order to estimate the probability that tracking is successful |
CvpRBRenderData | Render data storage |
CvpRBSilhouetteCCDTracker | Tracking based on the Contracting Curve Density algorithm |
CvpRBSilhouetteControlPoint | Trackable silhouette point representation |
CvpRBSilhouetteMeTracker | Moving edge feature tracking from depth-extracted object contours |
CvpRBSilhouettePoint | Silhouette point simple candidate representation |
CvpRBTracker | |
CvpRBTrackerLogger | |
CvpRBVisualOdometry | |
►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 | |
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 |
CvpRobotBebop2 | |
CvpRobotBiclops | Interface for the Biclops, pan, tilt head control |
CvpRobotException | Error that can be emitted by the vpRobot class and its derivatives |
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 |
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 |
CvpRobust | Contains an M-estimator and various influence function |
CvpRotationMatrix | Implementation of a rotation matrix and operations on such kind of matrices |
CvpRotationVector | Implementation of a generic rotation vector |
CvpRowVector | Implementation of row vector and the associated operations |
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 |
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 | |
CvpServer | This class represents a Transmission Control Protocol (TCP) server |
CvpServo | |
CvpServoData | Save data during the task execution when using vpServo |
CvpServoDisplay | Interface with the image for feature display |
CvpServoException | Error that can be emitted by the vpServo class and its derivatives |
CvpSilhouettePointsExtractionSettings | Silhouette point extraction settings |
CvpSimulator | Implementation of a simulator based on Coin3d (www.coin3d.org) |
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 |
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 |
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 |
CvpStatisticalTestShewhart | Class that permits a Shewhart's test |
CvpStatisticalTestSigma | Class that permits a simple test comparing the current value to the standard deviation of the signal |
CvpSubColVector | |
CvpSubMatrix | Definition of the vpSubMatrix class that provides a mask on a vpMatrix. All properties of vpMatrix are available with a vpSubMatrix |
CvpSubRowVector | |
CvpTemplateTracker | |
CvpTemplateTrackerDPoint | |
CvpTemplateTrackerMI | |
CvpTemplateTrackerMIESM | |
CvpTemplateTrackerMIForwardAdditional | |
CvpTemplateTrackerMIForwardCompositional | |
CvpTemplateTrackerMIInverseCompositional | |
CvpTemplateTrackerPoint | |
CvpTemplateTrackerPointCompo | |
CvpTemplateTrackerSSD | |
CvpTemplateTrackerSSDESM | |
CvpTemplateTrackerSSDForwardAdditional | |
CvpTemplateTrackerSSDForwardCompositional | |
CvpTemplateTrackerSSDInverseCompositional | |
CvpTemplateTrackerTriangle | |
CvpTemplateTrackerWarp | |
CvpTemplateTrackerWarpAffine | |
CvpTemplateTrackerWarpHomography | |
CvpTemplateTrackerWarpHomographySL3 | |
CvpTemplateTrackerWarpRT | |
CvpTemplateTrackerWarpSRT | |
CvpTemplateTrackerWarpTranslation | |
CvpTemplateTrackerZNCC | |
CvpTemplateTrackerZNCCForwardAdditional | |
CvpTemplateTrackerZNCCInverseCompositional | |
CvpTemplateTrackerZone | |
CvpTemplateTrackerZPoint | |
CvpThetaUVector | Implementation of a rotation vector as axis-angle minimal representation |
CvpTraceOutput | This class is used to display debug or error messages |
CvpTracker | Class that defines what is a feature generic tracker |
CvpTrackingException | Error that can be emitted by the vpTracker class and its derivatives |
CvpTranslationVector | Class that consider the case of a translation vector |
CvpTriangle | Defines a 2D triangle |
CvpUDPClient | This class implements a basic (IPv4) User Datagram Protocol (UDP) client |
CvpUDPServer | This class implements a basic (IPv4) User Datagram Protocol (UDP) server |
CvpUeyeGrabber | |
►CvpUKSigmaDrawerAbstract | |
CvpUKSigmaDrawerMerwe | |
CvpUnicycle | Generic functions for unicycle mobile robots |
CvpUniRand | Class for generating random numbers with uniform probability density |
CvpUnscentedKalman | |
CvpV4l2Grabber | Class that is a wrapper over the Video4Linux2 (V4L2) driver |
CvpVelocityTwistMatrix | |
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 |
CvpVideoWriter | Class that enables to write easily a video file or a sequence of images |
CvpViewer | Viewer used by the simulator |
CvpViper | Modelization of the ADEPT Viper robot |
CvpViper650 | Modelization of the ADEPT Viper 650 robot |
CvpViper850 | Modelization of the ADEPT Viper 850 robot |
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 |