Visual Servoing Platform  version 3.6.1 under development (2024-03-18)
Class List
Here are the classes, structs, unions and interfaces with brief descriptions:
[detail level 123]
 Nbuminiz
 NTutorialMeanDrift
 Nvisp
 Nvp
 CArguments[Enum conversion]
 CClassUsingPclViewer
 CImageDisplay(withContext)
 CServoingExperimentData[Custom ViSP object conversion]
 Cvp1394CMUGrabberFirewire cameras video capture based on CMU 1394 Digital Camera SDK
 Cvp1394TwoGrabberClass for firewire ieee1394 video devices using libdc1394-2.x api
 CvpAdaptiveGainAdaptive gain computation
 CvpAfma4Modelization of Irisa's cylindrical robot named Afma4
 CvpAfma6Modelization of Irisa's gantry robot named Afma6
 CvpARImplementation of an augmented reality viewer using Coin3D 3rd party
 CvpAROgreImplementation of an augmented reality viewer using Ogre3D 3rd party
 CvpArray2DImplementation of a generic 2D array used as base class for matrices and vectors
 CvpBasicFeatureClass that defines what is a visual feature
 CvpBasicKeyPointClass 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
 CvpBiclopsJacobian, geometric model functionalities... for Biclops, pan, tilt head
 CvpBSplineClass that provides tools to compute and manipulate a B-Spline curve
 CvpCalibrationTools for perspective camera calibration
 CvpCalibrationExceptionError that can be emitted by the vpCalibration class
 CvpCameraParametersGeneric class defining intrinsic camera parameters
 CvpCannyEdgeDetectionJson namespace shortcut
 CvpChrono
 CvpCircleClass 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
 CvpCircleHoughTransformClass that permits to detect 2D circles in a image using the gradient-based Circle Hough transform. Please find more information on the algorithm here
 CvpClientThis class represents a Transmission Control Protocol (TCP) client
 CvpColorClass to define RGB colors available for display functionalities
 CvpColorBlindFriendlyPaletteClass that furnishes a set of colors that color blind people should be able to distinguish one from another
 CvpColorDepthConversion
 CvpColormapCreates a colormap class to be able to recolor an image with different grayscale values into some corresponding color values, for better visualization for example
 CvpColVectorImplementation of column vector and the associated operations
 CvpComedi
 CvpConvert
 CvpCylinderClass 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
 CvpDetectorQRCode
 CvpDirectShowGrabberClass for windows direct show devices
 CvpDiskGrabberClass to grab (ie. read) images from the disk
 CvpDisplayClass that defines generic functionalities for display
 CvpDisplayD3DDisplay 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/
 CvpDisplayExceptionError that can be emitted by the vpDisplay class and its derivatives
 CvpDisplayGDIDisplay for windows using GDI (available on any windows 32 platform)
 CvpDisplayGTKThe 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
 CvpDisplayOpenCVThe 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
 CvpDisplayWin32Base 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)
 CvpDisplayXUse the X11 console to display images on unix-like OS. Thus to enable this class X11 should be installed. Installation instructions are provided here https://visp.inria.fr/3rd_x11
 CvpDotThis tracker is meant to track a dot (connected pixels with same gray level) on a vpImage
 CvpDot2This tracker is meant to track a blob (connex pixels with same gray level) on a vpImage
 CvpExceptionError that can be emitted by ViSP classes
 CvpExponentialMapDirect or inverse exponential map computation
 CvpFeatureBuilderClass that defines conversion between trackers and visual features
 CvpFeatureDepthClass that defines a 3D point visual feature $ s$ which is composed by one parameters that is $ log( \frac{Z}{Z^*}) $ that defines the current depth relative to the desired depth. Here $ Z $ represents the current depth and $ Z^* $ the desired depth
 CvpFeatureDisplayInterface with the image for feature display
 CvpFeatureEllipseClass that defines 2D ellipse visual feature
 CvpFeatureExceptionError that can be emitted by the vpBasicFeature class and its derivates
 CvpFeatureLineClass that defines a 2D line visual feature $ s$ which is composed by two parameters that are $ \rho $ and $ \theta $, the polar coordinates of a line
 CvpFeatureLuminanceClass that defines the image luminance visual feature
 CvpFeatureMomentThis class defines shared system methods/attributes for 2D moment features but no functional code. It is used to compute interaction matrices for moment features
 CvpFeatureMomentAlphaFunctionality computation for in-plane rotation moment feature $ \alpha $: computes the interaction matrix associated with vpMomentAlpha
 CvpFeatureMomentAreaSurface moment feature. Computes the interaction matrix associated with vpMomentArea
 CvpFeatureMomentAreaNormalizedFunctionality computation for normalized surface moment feature. Computes the interaction matrix associated with vpMomentAreaNormalized
 CvpFeatureMomentBasicFunctionality computation for basic moment feature. Computes the interaction matrix associated with vpMomentBasic
 CvpFeatureMomentCenteredFunctionality computation for centered moment feature. Computes the interaction matrix associated with vpMomentCentered
 CvpFeatureMomentCInvariantFunctionality computation for 2D rotation/translation/scale non-symmetric invariant moment feature. Computes the interaction matrix associated with vpMomentCInvariant
 CvpFeatureMomentCommonThis class allows to access common vpFeatureMoments in a pre-filled database
 CvpFeatureMomentDatabaseThis class allows to register all feature moments (implemented in vpFeatureMoment... classes) so they can access each other according to their dependencies
 CvpFeatureMomentGravityCenterFunctionality computation for gravity center moment feature. Computes the interaction matrix associated with vpMomentGravityCenter
 CvpFeatureMomentGravityCenterNormalizedFunctionality computation for centered and normalized moment feature. Computes the interaction matrix associated with vpMomentGravityCenterNormalized
 CvpFeaturePointClass that defines a 2D point visual feature $ s$ which is composed by two parameters that are the cartesian coordinates $ x $ and $ y $
 CvpFeaturePoint3DClass that defines the 3D point visual feature
 CvpFeaturePointPolarClass that defines 2D image point visual feature with polar coordinates $(\rho,\theta)$ described in [10]
 CvpFeatureSegmentClass that defines a 2D segment visual features. This class allow to consider two sets of visual features:
 CvpFeatureThetaUClass that defines a 3D visual feature $ s$ from a $ \theta u $ axis/angle parametrization that represent the rotation between to frames
 CvpFeatureTranslationClass that defines the translation visual feature $s=(t_x,t_y,t_z)$
 CvpFeatureVanishingPoint
 CvpFlyCaptureGrabber
 CvpFontFont drawing functions for image
 CvpForceTorqueAtiNetFTSensor
 CvpForceTorqueAtiSensor
 CvpForceTorqueIitSensor
 CvpForceTwistMatrix
 CvpForwardProjectionClass that defines what is a generic geometric feature
 CvpFrameGrabberBase class for all video devices. It is designed to provide a front end to video sources
 CvpFrameGrabberExceptionError that can be emitted by the vpFrameGrabber class and its derivates
 CvpGaussianFilterGaussian filter class
 CvpGaussRandClass for generating random number with normal probability density
 CvpGenericFeatureClass 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
 CvpHandEyeCalibrationTool for hand-eye calibration
 CvpHinkleyThis class implements the Hinkley's cumulative sum test
 CvpHistogramClass to compute a gray level image histogram
 CvpHistogramPeakDeclaration of the peak (maximum value) in a gray level image histogram
 CvpHistogramValeyDeclaration of the valey (minimum value) in a gray level image histogram
 CvpHomogeneousMatrixImplementation of an homogeneous matrix and operations on such kind of matrices
 CvpHomographyImplementation of an homography and operations on homographies
 CvpImageDefinition of the vpImage class member functions
 CvpImageCircleClass that defines a 2D circle in an image
 CvpImageConvert
 CvpImageDrawDrawing functions for image
 CvpImageExceptionError that can be emitted by the vpImage class and its derivatives
 CvpImageFilterVarious image filter, convolution, etc..
 CvpImageIoRead/write images with various image format
 CvpImageMorphologyVarious mathematical morphology tools, erosion, dilatation..
 CvpImagePointClass 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
 CvpImageQueue
 CvpImageSimulatorClass which enables to project an image in the 3D space and get the view of a virtual camera
 CvpImageStorageWorker
 CvpImageToolsVarious image tools; sub-image extraction, modification of the look up table, binarisation..
 CvpIoExceptionError that can be emitted by the vpIoTools class and its derivatives
 CvpIoToolsFile and directories basic tools
 CvpJsonArgumentParserCommand 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
 CvpKalmanFilterThis class provides a generic Kalman filtering algorithm along with some specific state model (constant velocity, constant acceleration) which are implemented in the vpLinearKalmanFilterInstantiation class
 CvpKeyboardKeyboard management under unix (Linux or OSX). This class is not available under windows
 CvpKeyPointClass 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
 CvpKinectDriver for the Kinect-1 device
 CvpKltOpencvWrapper 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
 CvpLaserScanImplements a laser scan data structure that contains especially the list of scanned points that have been recorded for this laser scan
 CvpLaserScannerClass that defines a generic laser scanner
 CvpLineClass 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
 CvpLinearKalmanFilterInstantiationThis class provides an implementation of some specific linear Kalman filters
 CvpLinProgThis class provides two solvers for Linear Programs
 CvpListProvide simple list management
 CvpMathProvides simple mathematics computation tools that are not available in the C mathematics library (math.h)
 CvpMatrixImplementation of a matrix and operations on matrices
 CvpMatrixExceptionError that can be emitted by the vpMatrix class and its derivatives
 CvpMbDepthDenseTracker
 CvpMbDepthNormalTracker
 CvpMbEdgeKltTrackerHybrid tracker based on moving-edges and keypoints tracked using KLT tracker
 CvpMbEdgeTrackerMake the complete tracking of an object by using its CAD model
 CvpMbGenericTrackerReal-time 6D object pose tracking using its CAD model
 CvpMbHiddenFacesImplementation of the polygons management for the model-based trackers
 CvpMbKltTrackerModel based tracker using only KLT
 CvpMbtDistanceCircleManage a circle used in the model-based tracker
 CvpMbtDistanceCylinderManage a cylinder used in the model-based tracker
 CvpMbtDistanceKltCylinderImplementation of a polygon of the model containing points of interest. It is used by the model-based tracker KLT, and hybrid
 CvpMbtDistanceKltPointsImplementation of a polygon of the model containing points of interest. It is used by the model-based tracker KLT, and hybrid
 CvpMbtDistanceLineManage the line of a polygon used in the model-based tracker
 CvpMbtFaceDepthDense
 CvpMbtFaceDepthNormal
 CvpMbtPolygonImplementation of a polygon of the model used by the model-based tracker
 CvpMbTrackerMain methods for a model-based tracker
 CvpMbtXmlGenericParserParse an Xml file to extract configuration parameters of a mbtConfig object
 CvpMe
 CvpMeEllipseClass that tracks an ellipse using moving edges
 CvpMegaPose
 CvpMegaPoseEstimate
 CvpMegaPoseTrackerA 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
 CvpMeLineClass that tracks in an image a line moving edges
 CvpMeNurbsClass that tracks in an image a edge defined by a Nurbs
 CvpMeSitePerforms 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
 CvpMeTrackerContains abstract elements for a Distance to Feature type feature
 CvpMocap
 CvpMocapQualisys
 CvpMocapVicon
 CvpMomentThis class defines shared methods/attributes for 2D moments
 CvpMomentAlphaThis class defines the orientation of the object inside the plane parallel to the object
 CvpMomentAreaClass handling the surface moment
 CvpMomentAreaNormalizedClass handling the normalized surface moment that is invariant in scale and used to estimate depth
 CvpMomentBasicThis class defines the 2D basic moment $m_{ij}$. This class is a wrapper for vpMomentObject wich allows to use it as a moment. This enables all common operations such as adding to a vpMomentDatabase
 CvpMomentCenteredThis class defines the double-indexed centered moment descriptor $\mu_{ij}$
 CvpMomentCInvariant
 CvpMomentCommonThis class initializes and allows access to commonly used moments
 CvpMomentDatabaseThis class allows to register all vpMoments so they can access each other according to their dependencies
 CvpMomentGenericFeatureThis class defines a generic feature used for moment feature duplication
 CvpMomentGravityCenterClass describing 2D gravity center moment
 CvpMomentGravityCenterNormalizedClass describing 2D normalized gravity center moment
 CvpMomentObjectClass for generic objects
 CvpMouseButtonClass that defines mouse button identifiers
 CvpMutex
 CvpNetworkThis class represents a Transmission Control Protocol (TCP) network
 CvpNurbsClass that provides tools to compute and manipulate a Non Uniform Rational B-Spline curve
 CvpOccipitalStructure
 CvpParallelPortParallel port management under unix
 CvpParallelPortExceptionError that can be emitted by the vpParallelPort class and its derivates
 CvpParseArgvCommand line argument parsing
 CvpPclViewer
 CvpPioneerGeneric functions for Pioneer mobile robots
 CvpPioneerPanGeneric functions for Pioneer mobile robots equipped with a pan head
 CvpPixelMeterConversion
 CvpPlaneThis class defines the container for a plane geometrical structure
 CvpPlotThis 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
 CvpPointClass 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
 CvpPololuInterface for the Pololu Maestro USB Servo Controllers
 CvpPolygonDefines a generic 2D polygon
 CvpPolygon3DImplements a 3D polygon with render functionalities like clipping
 CvpPoseClass used for pose computation from N points (pose from point only). Some of the algorithms implemented in this class are described in [34]
 CvpPoseExceptionError that can be emitted by the vpPose class and its derivatives
 CvpPoseFeaturesTools for pose computation from any feature
 CvpPoseVectorImplementation of a pose vector and operations on poses
 CvpProjectionDisplayInterface with the image for feature display
 CvpPtu46Jacobian, geometric model functionalities... for ptu46, pan, tilt head from Directed Perception
 CvpPylonFactoryFactory singleton class to create vpPylonGrabber subclass instances
 CvpPylonGrabber
 CvpPylonGrabberGigE
 CvpPylonGrabberUsb
 CvpQbDevice
 CvpQbSoftHand
 CvpQuadProgThis class provides a solver for Quadratic Programs
 CvpQuaternionVectorImplementation of a rotation vector as quaternion angle minimal representation
 CvpRansacThis class is a generic implementation of the Ransac algorithm. It cannot be used alone
 CvpRealSense
 CvpRealSense2
 CvpRectDefines a rectangle in the plane
 CvpRectOrientedDefines an oriented rectangle in the plane
 CvpReflexTakktile2
 CvpRequestThis the request that will transit on the network
 CvpRGBa
 CvpRGBf
 CvpRingLightRing light management under unix
 CvpRobotClass that defines a generic virtual robot
 CvpRobotAfma4Control of Irisa's cylindrical robot named Afma4
 CvpRobotAfma6Control of Irisa's gantry robot named Afma6
 CvpRobotBebop2
 CvpRobotBiclopsInterface for the Biclops, pan, tilt head control
 CvpRobotCameraClass that defines the simplest robot: a free flying camera. We recommend to use vpSimulatorCamera instead
 CvpRobotExceptionError that can be emitted by the vpRobot class and its derivatives
 CvpRobotFlirPtu
 CvpRobotFranka
 CvpRobotKinova
 CvpRobotPioneerInterface for Pioneer mobile robots based on Aria 3rd party library
 CvpRobotPololuPtuInterface for the Pololu Maestro pan-tilt unit using two servo motors
 CvpRobotPtu46Interface for the Directed Perception ptu-46 pan, tilt head
 CvpRobotSimulatorThis class aims to be a basis used to create all the robot simulators
 CvpRobotTemplateClass that defines a robot just to show which function you must implement
 CvpRobotUniversalRobots
 CvpRobotViper650Control of Irisa's Viper S650 robot named Viper650
 CvpRobotViper850
 CvpRobotWireFrameSimulatorThis class aims to be a basis used to create all the simulators of robots
 CvpRobustContains an M-estimator and various influence function
 CvpRotationMatrixImplementation of a rotation matrix and operations on such kind of matrices
 CvpRotationVectorImplementation of a generic rotation vector
 CvpRowVectorImplementation of row vector and the associated operations
 CvpRxyzVectorImplementation of a rotation vector as $R(x,y,z)$ Euler angle minimal representation
 CvpRzyxVectorImplementation of a rotation vector as $R(z,y,x)$ Euler angle minimal representation
 CvpRzyzVectorImplementation of a rotation vector as $R(z,y,z)$ Euler angle minimal representation
 CvpScaleContains various estimators for scale.
Methods : Median Absolute Deviation (MAD), MPDE, Mean shift kernel density estimation
 CvpScanPointClass that defines a single laser scanner point
 CvpSerial
 CvpServerThis class represents a Transmission Control Protocol (TCP) server
 CvpServo
 CvpServoDataSave data during the task execution when using vpServo
 CvpServoDisplayInterface with the image for feature display
 CvpServoExceptionError that can be emitted by the vpServo class and its derivatives
 CvpServolensInterface for the Servolens lens attached to the camera fixed on the Afma4 robot
 CvpSickLDMRSDriver for the Sick LD-MRS laser scanner
 CvpSimulatorImplementation of a simulator based on Coin3d (www.coin3d.org)
 CvpSimulatorAfma6Simulator of Irisa's gantry robot named Afma6
 CvpSimulatorCameraClass that defines the simplest robot: a free flying camera
 CvpSimulatorExceptionError that can be emitted by the vpSimulator class and its derivatives
 CvpSimulatorPioneerClass that defines the Pioneer mobile robot simulator equipped with a static camera
 CvpSimulatorPioneerPanClass that defines the Pioneer mobile robot simulator equipped with a camera able to move in pan
 CvpSimulatorViper850Simulator of Irisa's Viper S850 robot named Viper850
 CvpSphereClass 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
 CvpStatisticalTestAbstractBase class for methods detecting the drift of the mean of a process
 CvpStatisticalTestEWMAClass that permits to perform Exponentially Weighted Moving Average mean drft tests
 CvpStatisticalTestHinkleyThis class implements the Hinkley's cumulative sum test
 CvpStatisticalTestMeanAdjustedCUSUMClass that permits to perform a mean adjusted Cumulative Sum test
 CvpStatisticalTestShewhartClass that permits a Shewhart's test
 CvpStatisticalTestSigmaClass that permits a simple test comparing the current value to the standard deviation of the signal
 CvpSubColVector
 CvpSubMatrixDefinition 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
 CvpThetaUVectorImplementation of a rotation vector as $\theta {\bf u}$ axis-angle minimal representation
 CvpThread
 CvpTraceOutputThis class is used to display debug or error messages
 CvpTrackerClass that defines what is a feature generic tracker
 CvpTrackingExceptionError that can be emitted by the vpTracker class and its derivatives
 CvpTranslationVectorClass that consider the case of a translation vector
 CvpTriangleDefines a 2D triangle
 CvpUDPClientThis class implements a basic (IPv4) User Datagram Protocol (UDP) client
 CvpUDPServerThis class implements a basic (IPv4) User Datagram Protocol (UDP) server
 CvpUeyeGrabber
 CvpUnicycleGeneric functions for unicycle mobile robots
 CvpUniRandClass for generating random numbers with uniform probability density
 CvpV4l2GrabberClass that is a wrapper over the Video4Linux2 (V4L2) driver
 CvpVelocityTwistMatrix
 CvpVideoReaderClass 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
 CvpVideoWriterClass that enables to write easily a video file or a sequence of images
 CvpViewerViewer used by the simulator
 CvpViperModelization of the ADEPT Viper robot
 CvpViper650Modelization of the ADEPT Viper 650 robot
 CvpViper850Modelization of the ADEPT Viper 850 robot
 CvpVirtualGrabber
 CvpVirtuose
 CvpWireFrameSimulatorImplementation of a wire frame simulator. Compared to the vpSimulator class, it does not require third party libraries to be used
 CvpXmlConfigParserKeyPoint
 CvpXmlParser
 CvpXmlParserCameraXML parser to load and save intrinsic camera parameters
 CvpXmlParserHomogeneousMatrixXML parser to load and save an homogeneous matrix in a file
 CvpXmlParserRectOrientedXML parser to load and save an oriented rectangle in a file