C# Класс Emgu.CV.CvInvoke

Показать файл Открыть проект Примеры использования класса

Открытые методы

Метод Описание
CV_FOURCC ( char c1, char c2, char c3, char c4 ) : int

Generate 4-character code of codec used to compress the frames. For example, CV_FOURCC('P','I','M','1') is MPEG-1 codec, CV_FOURCC('M','J','P','G') is motion-jpeg codec etc.

CV_MAKETYPE ( int depth, int cn ) : int

This function performs the same as CV_MAKETYPE macro

GetModuleFormatString ( ) : String

Get the module format string.

LoadUnmanagedModules ( String loadDirectory ) : bool

Attemps to load opencv modules from the specific location

If loadDirectory is null, the default location on windows is the dll's path appended by either "x64" or "x86", depends on the applications current mode.

cvBoundingRect ( IntPtr points, bool update ) : Rectangle

Returns the up-right bounding rectangle for 2d point set

cvCalcArrHist ( IntPtr image, IntPtr hist, bool accumulate, IntPtr mask ) : void

Calculates the histogram of one or more single-channel images. The elements of a tuple that is used to increment a histogram bin are taken at the same location from the corresponding input images.

cvCalcEigenObjects ( IntPtr input, MCvTermCriteria &calcLimit, IntPtr eigVecs, float eigVals, IntPtr avg ) : void

Calculates orthonormal eigen basis and the averaged object for a group of the input objects.

cvCalcHist ( IntPtr image, IntPtr hist, bool accumulate, IntPtr mask ) : void

Calculates the histogram of one or more single-channel images. The elements of a tuple that is used to increment a histogram bin are taken at the same location from the corresponding input images.

cvContourPerimeter ( IntPtr contour ) : double

Find the perimeter of the contour

cvCreateHist ( int dims, [ sizes, CvEnum type, [ ranges, bool uniform ) : IntPtr

Creates a histogram of the specified size and returns the pointer to the created histogram. If the array ranges is 0, the histogram bin ranges must be specified later via The function cvSetHistBinRanges, though cvCalcHist and cvCalcBackProject may process 8-bit images without setting bin ranges, they assume equally spaced in 0..255 bins

cvCreateSubdivDelaunay2D ( Rectangle rect, IntPtr storage ) : IntPtr

Creates an empty Delaunay subdivision, where 2d points can be added further using function cvSubdivDelaunay2DInsert. All the points to be added must be within the specified rectangle, otherwise a runtime error will be raised.

cvCreateVideoWriter ( String filename, int fourcc, double fps, System frameSize, bool isColor ) : IntPtr

Creates video writer structure.

cvEigenDecomposite ( IntPtr obj, IntPtr eigInput, IntPtr avg ) : float[]

Calculates all decomposition coefficients for the input object using the previously calculated eigen objects basis and the averaged object

cvEigenProjection ( IntPtr inputVecs, float coeffs, IntPtr avg, IntPtr proj ) : void

Calculates an object projection to the eigen sub-space or, in other words, restores an object using previously calculated eigen objects basis, averaged object, and decomposition coefficients of the restored object.

cvFloodFill ( IntPtr src, Point seedPoint, MCvScalar newVal, MCvScalar loDiff, MCvScalar upDiff, MCvConnectedComp &comp, CvEnum connectivity, CvEnum flags, IntPtr mask ) : void

Fills a connected component with given color.

cvNamedWindow ( String name ) : int

Creates a window which can be used as a placeholder for images and trackbars. Created windows are reffered by their names. If the window with such a name already exists, the function does nothing.

cvPointPolygonTest ( IntPtr contour, PointF pt, bool measureDist ) : double

Determines whether the point is inside contour, outside, or lies on an edge (or coinsides with a vertex). It returns positive, negative or zero value, correspondingly

cvSnakeImage ( IntPtr image, IntPtr points, int length, float alpha, float beta, float gamma, int coeffUsage, Size win, MCvTermCriteria criteria, bool calcGradient ) : void

Updates snake in order to minimize its total energy that is a sum of internal energy that depends on contour shape (the smoother contour is, the smaller internal energy is) and external energy that depends on the energy field and reaches minimum at the local energy extremums that correspond to the image edges in case of image gradient.

Приватные методы

Метод Описание
ApplyColorMap ( IntPtr src, IntPtr dst, CvEnum colorMapType ) : void
CvBackgroundSubtractorMOG2Create ( int history, float varThreshold, [ bShadowDetection ) : IntPtr
CvBackgroundSubtractorMOG2Release ( IntPtr &bgSubstractor ) : void
CvBackgroundSubtractorMOGCreate ( int history, int nmixtures, double backgroundRatio, double noiseSigma ) : IntPtr
CvBackgroundSubtractorMOGRelease ( IntPtr &bgSubstractor ) : void
CvBlobDetectorDetectNewBlob ( IntPtr detector, IntPtr img, IntPtr imgFG, IntPtr newBlobList, IntPtr oldBlobList ) : bool
CvBlobDetectorRelease ( IntPtr &detector ) : void
CvBlobSeqAddBlob ( IntPtr blobSeq, MCvBlob &blob ) : void
CvBlobSeqClear ( IntPtr blobSeq ) : void
CvBlobSeqCreate ( int blobSize ) : IntPtr
CvBlobSeqGetBlob ( IntPtr blobSeq, int blobIndex ) : IntPtr
CvBlobSeqGetBlobByID ( IntPtr blobSeq, int blobId ) : IntPtr
CvBlobSeqGetBlobNum ( IntPtr blobSeq ) : int
CvBlobSeqRelease ( IntPtr &blobSeq ) : void
CvBlobTrackPostProcRelease ( IntPtr &postProc ) : void
CvBlobTrackerAddBlob ( IntPtr tracker, MCvBlob &blob, IntPtr currentImage, IntPtr currentForegroundMask ) : IntPtr
CvBlobTrackerDelBlob ( IntPtr tracker, int blobIndex ) : void
CvBlobTrackerGetBlob ( IntPtr tracker, int blobIndex ) : IntPtr
CvBlobTrackerGetBlobByID ( IntPtr tracker, int blobId ) : IntPtr
CvBlobTrackerGetBlobNum ( IntPtr tracker ) : int
CvBlobTrackerRealease ( IntPtr &tracker ) : void
CvCascadeClassifierCreate ( [ fileName ) : IntPtr
CvCascadeClassifierDetectMultiScale ( IntPtr classifier, IntPtr image, IntPtr objects, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize ) : void
CvCascadeClassifierRelease ( IntPtr &classifier ) : void
CvCreateBlobDetectorCC ( ) : IntPtr
CvCreateBlobDetectorSimple ( ) : IntPtr
CvCreateBlobTrackerCC ( ) : IntPtr
CvCreateBlobTrackerCCMSPF ( ) : IntPtr
CvCreateBlobTrackerMS ( ) : IntPtr
CvCreateBlobTrackerMSFG ( ) : IntPtr
CvCreateBlobTrackerMSFGS ( ) : IntPtr
CvCreateBlobTrackerMSPF ( ) : IntPtr
CvCreateModuleBlobTrackPostProcKalman ( ) : IntPtr
CvCreateModuleBlobTrackPostProcTimeAverExp ( ) : IntPtr
CvCreateModuleBlobTrackPostProcTimeAverRect ( ) : IntPtr
CvDenseFeatureDetectorCreate ( float initFeatureScale, int featureScaleLevels, float featureScaleMul, int initXyStep, int initImgBound, [ varyXyStepWithScale, [ varyImgBoundWithScale ) : IntPtr
CvDenseFeatureDetectorRelease ( IntPtr &detector ) : void
CvEigenFaceRecognizerCreate ( int numComponents, double threshold ) : IntPtr
CvFASTFeatureDetectorRelease ( IntPtr &detector ) : void
CvFASTGetFeatureDetector ( int threshold, [ nonmax_supression ) : IntPtr
CvFaceRecognizerLoad ( IntPtr recognizer, [ fileName ) : void
CvFaceRecognizerPredict ( IntPtr recognizer, IntPtr image, int &label, double &distance ) : void
CvFaceRecognizerRelease ( IntPtr &recognizer ) : void
CvFaceRecognizerSave ( IntPtr recognizer, [ fileName ) : void
CvFaceRecognizerTrain ( IntPtr recognizer, IntPtr images, IntPtr labels, int count ) : void
CvFeatureDetectorDetectKeyPoints ( IntPtr detector, IntPtr image, IntPtr mask, IntPtr keypoints ) : void
CvFisherFaceRecognizerCreate ( int numComponents, double threshold ) : IntPtr
CvFlannIndexCreateAutotuned ( IntPtr features, float targetPrecision, float buildWeight, float memoryWeight, float sampleFraction ) : IntPtr
CvFlannIndexCreateComposite ( IntPtr features, int numberOfKDTrees, int branching, int iterations, Flann centersInitType, float cbIndex ) : IntPtr
CvFlannIndexCreateKDTree ( IntPtr features, int numberOfKDTrees ) : IntPtr
CvFlannIndexCreateKMeans ( IntPtr features, int branching, int iterations, Flann centersInitType, float cbIndex ) : IntPtr
CvFlannIndexCreateLinear ( IntPtr features ) : IntPtr
CvFlannIndexKnnSearch ( IntPtr index, IntPtr queries, IntPtr indices, IntPtr dists, int knn, int checks ) : void
CvFlannIndexRadiusSearch ( IntPtr index, IntPtr queries, IntPtr indices, IntPtr dists, float radius, int checks ) : int
CvFlannIndexRelease ( IntPtr index ) : void
CvGFTTDetectorCreate ( int maxCorners, double qualityLevel, double minDistance, int blockSize, bool useHarrisDetector, double k ) : IntPtr
CvGFTTDetectorRelease ( IntPtr &detector ) : void
CvGrabCut ( IntPtr img, IntPtr mask, Rectangle &rect, IntPtr bgdModel, IntPtr fgdModel, int iterCount, CvEnum type ) : void
CvHOGDescriptorCompute ( IntPtr descriptor, IntPtr img, IntPtr descriptors, Size winStride, Size padding, IntPtr locations ) : void
CvHOGDescriptorCreate ( Size &winSize, Size &blockSize, Size &blockStride, Size &cellSize, int nbins, int derivAperture, double winSigma, int histogramNormType, double L2HysThreshold, [ gammaCorrection ) : IntPtr
CvHOGDescriptorCreateDefault ( ) : IntPtr
CvHOGDescriptorDetectMultiScale ( IntPtr descriptor, IntPtr img, IntPtr foundLocations, double hitThreshold, Size winStride, Size padding, double scale, double finalThreshold, [ useMeanshiftGrouping ) : void
CvHOGDescriptorGetDescriptorSize ( IntPtr descriptor ) : uint
CvHOGDescriptorPeopleDetectorCreate ( IntPtr seq ) : void
CvHOGDescriptorRelease ( IntPtr descriptor ) : void
CvHOGSetSVMDetector ( IntPtr descriptor, IntPtr svmDetector ) : void
CvInvoke ( ) : System

Static Constructor to setup opencv environment

CvLBPHFaceRecognizerCreate ( int radius, int neighbors, int gridX, int gridY, double threshold ) : IntPtr
CvLDetectorDetectKeyPoints ( Features2D &detector, IntPtr image, IntPtr keypoints, int maxCount, [ scaleCoords ) : void
CvMserFeatureDetectorRelease ( IntPtr &detector ) : void
CvMserGetFeatureDetector ( MCvMSERParams &detector ) : IntPtr
CvOctreeBuildTree ( IntPtr tree, IntPtr points, int numberOfPoints, int maxLevels, int minPoints ) : void
CvOctreeCreate ( ) : IntPtr
CvOctreeGetPointsWithinSphere ( IntPtr tree, MCvPoint3D32f &center, float radius, IntPtr pointSeq ) : void
CvOctreeRelease ( IntPtr tree ) : void
CvPatchGeneratorInit ( Features2D &pg ) : void
CvPlanarObjectDetectorDefaultCreate ( ) : IntPtr
CvPlanarObjectDetectorDetect ( IntPtr detector, IntPtr image, IntPtr homography, IntPtr corners ) : void
CvPlanarObjectDetectorGetModelPoints ( IntPtr detector, IntPtr modelPoints ) : void
CvPlanarObjectDetectorRelease ( IntPtr detector ) : void
CvPlanarObjectDetectorTrain ( IntPtr objectDetector, IntPtr image, int npoints, int patchSize, int nstructs, int structSize, int nviews, LDetector &keyPointDetector, PatchGenerator &patchGenerator ) : void
CvRetinaClearBuffers ( IntPtr retina ) : void
CvRetinaCreate ( Size inputSize, [ colorMode, Retina colorSamplingMethod, [ useRetinaLogSampling, double reductionFactor, double samplingStrength ) : IntPtr
CvRetinaGetMagno ( IntPtr retina, IntPtr magno ) : void
CvRetinaGetParameters ( IntPtr retina, Retina &parameters ) : void
CvRetinaGetParvo ( IntPtr retina, IntPtr parvo ) : void
CvRetinaRelease ( IntPtr &retina ) : void
CvRetinaRun ( IntPtr retina, IntPtr image ) : void
CvRetinaSetParameters ( IntPtr retina, Retina &parameters ) : void
CvSelfSimDescriptorCompute ( IntPtr descriptor, IntPtr image, IntPtr descriptors, Size &winStride, IntPtr locations, int sizeOfLocation ) : void
CvSelfSimDescriptorCreate ( int smallSize, int largeSize, int startDistanceBucket, int numberOfDistanceBuckets, int numberOfAngles ) : IntPtr
CvSelfSimDescriptorGetDescriptorSize ( IntPtr descriptor ) : int
CvSelfSimDescriptorRelease ( IntPtr descriptor ) : void
CvStarDetectorCreate ( int maxSize, int responseThreshold, int lineThresholdProjected, int lineThresholdBinarized, int suppressNonmaxSize ) : IntPtr
CvStarDetectorRelease ( IntPtr &detector ) : void
CvStereoSGBMCreate ( int minDisparity, int numDisparities, int SADWindowSize, int P1, int P2, int disp12MaxDiff, int preFilterCap, int uniquenessRatio, int speckleWindowSize, int speckleRange, [ fullDP ) : IntPtr
CvStereoSGBMFindCorrespondence ( IntPtr disparitySolver, IntPtr left, IntPtr right, IntPtr disparity ) : void
CvStereoSGBMRelease ( IntPtr obj ) : void
DataLoggerCreate ( int logLevel, int loggerId ) : IntPtr
DataLoggerLog ( IntPtr logger, IntPtr data, int logLevel ) : void
DataLoggerRegisterCallback ( IntPtr logger, Util messageCallback ) : void
DataLoggerRelease ( IntPtr &logger ) : void
GridAdaptedFeatureDetectorCreate ( IntPtr detector, int maxTotalKeypoints, int gridRows, int gridCols ) : IntPtr
GridAdaptedFeatureDetectorRelease ( IntPtr &detector ) : void
OpenniGetColorPoints ( IntPtr capture, IntPtr points, IntPtr mask ) : void
VectorOfByteClear ( IntPtr v ) : void
VectorOfByteCopyData ( IntPtr v, IntPtr data ) : void
VectorOfByteCreate ( ) : IntPtr
VectorOfByteCreateSize ( int size ) : IntPtr
VectorOfByteGetSize ( IntPtr v ) : int
VectorOfByteGetStartAddress ( IntPtr v ) : IntPtr
VectorOfBytePushMulti ( IntPtr v, IntPtr values, int count ) : void
VectorOfByteRelease ( IntPtr v ) : void
VectorOfDMatchClear ( IntPtr v ) : void
VectorOfDMatchCopyData ( IntPtr v, IntPtr data ) : void
VectorOfDMatchCreate ( ) : IntPtr
VectorOfDMatchCreateSize ( int size ) : IntPtr
VectorOfDMatchGetSize ( IntPtr v ) : int
VectorOfDMatchGetStartAddress ( IntPtr v ) : IntPtr
VectorOfDMatchPushMulti ( IntPtr v, IntPtr values, int count ) : void
VectorOfDMatchRelease ( IntPtr v ) : void
VectorOfDataMatrixCodeClear ( IntPtr v ) : void
VectorOfDataMatrixCodeCreate ( ) : IntPtr
VectorOfDataMatrixCodeCreateSize ( int size ) : IntPtr
VectorOfDataMatrixCodeDraw ( IntPtr v, IntPtr image ) : void
VectorOfDataMatrixCodeFind ( IntPtr v, IntPtr image ) : void
VectorOfDataMatrixCodeGetItem ( IntPtr v, int index ) : IntPtr
VectorOfDataMatrixCodeGetSize ( IntPtr v ) : int
VectorOfDataMatrixCodeGetStartAddress ( IntPtr v ) : IntPtr
VectorOfDataMatrixCodeRelease ( IntPtr v ) : void
VectorOfFloatClear ( IntPtr v ) : void
VectorOfFloatCopyData ( IntPtr v, IntPtr data ) : void
VectorOfFloatCreate ( ) : IntPtr
VectorOfFloatCreateSize ( int size ) : IntPtr
VectorOfFloatGetSize ( IntPtr v ) : int
VectorOfFloatGetStartAddress ( IntPtr v ) : IntPtr
VectorOfFloatPushMulti ( IntPtr v, IntPtr values, int count ) : void
VectorOfFloatRelease ( IntPtr v ) : void
VectorOfKeyPointClear ( IntPtr v ) : void
VectorOfKeyPointCopyData ( IntPtr v, IntPtr data ) : void
VectorOfKeyPointCreate ( ) : IntPtr
VectorOfKeyPointCreateSize ( int size ) : IntPtr
VectorOfKeyPointFilterByImageBorder ( IntPtr keypoints, Size imageSize, int borderSize ) : void
VectorOfKeyPointFilterByKeypointSize ( IntPtr keypoints, float minSize, float maxSize ) : void
VectorOfKeyPointFilterByPixelsMask ( IntPtr keypoints, IntPtr mask ) : void
VectorOfKeyPointGetItem ( IntPtr keypoints, int index, MKeyPoint &keypoint ) : void
VectorOfKeyPointGetSize ( IntPtr v ) : int
VectorOfKeyPointGetStartAddress ( IntPtr v ) : IntPtr
VectorOfKeyPointPushMulti ( IntPtr v, IntPtr values, int count ) : void
VectorOfKeyPointRelease ( IntPtr v ) : void
_cvNamedWindow ( [ name, int flags ) : int
cv2DRotationMatrix ( PointF center, double angle, double scale, IntPtr mapMatrix ) : IntPtr
cvAcc ( IntPtr image, IntPtr sum, IntPtr mask ) : void
cvAdaptiveThreshold ( IntPtr src, IntPtr dst, double maxValue, CvEnum adaptiveType, CvEnum thresholdType, int blockSize, double param1 ) : void
cvApproxPoly ( IntPtr srcSeq, int headerSize, IntPtr storage, CvEnum method, double parameter, int parameter2 ) : IntPtr
cvArcLength ( IntPtr curve, MCvSlice slice, int isClosed ) : double
cvBGCodeBookClearStale ( IntPtr model, int staleThresh, Rectangle roi, IntPtr mask ) : void
cvBGCodeBookClearStale ( MCvBGCodeBookModel &model, int staleThresh, Rectangle roi, IntPtr mask ) : void
cvBGCodeBookDiff ( IntPtr model, IntPtr image, IntPtr fgmask, Rectangle roi ) : int
cvBGCodeBookDiff ( MCvBGCodeBookModel &model, IntPtr image, IntPtr fgmask, Rectangle roi ) : int
cvBGCodeBookUpdate ( IntPtr model, IntPtr image, Rectangle roi, IntPtr mask ) : void
cvBGCodeBookUpdate ( MCvBGCodeBookModel &model, IntPtr image, Rectangle roi, IntPtr mask ) : void
cvBoundingRect ( IntPtr points, int update ) : Rectangle
cvBoxPoints ( MCvBox2D box, [ pt ) : void
cvCalcArrBackProject ( IntPtr image, IntPtr backProject, IntPtr hist ) : void
cvCalcArrHist ( IntPtr image, IntPtr hist, int accumulate, IntPtr mask ) : void
cvCalcBackProject ( IntPtr image, IntPtr backProject, IntPtr hist ) : void
cvCalcBackProjectPatch ( IntPtr images, IntPtr dst, Size patchSize, IntPtr hist, CvEnum method, double factor ) : void
cvCalcEMD2 ( IntPtr signature1, IntPtr signature2, CvEnum distType, CvDistanceFunction distFunc, IntPtr costMatrix, IntPtr flow, IntPtr lowerBound, IntPtr userParam ) : float
cvCalcEigenObjects ( int nObjects, IntPtr input, IntPtr output, CvEnum ioFlags, int ioBufSize, IntPtr userData, MCvTermCriteria &calcLimit, IntPtr avg, float eigVals ) : void
cvCalcGlobalOrientation ( IntPtr orientation, IntPtr mask, IntPtr mhi, double timestamp, double duration ) : double
cvCalcMotionGradient ( IntPtr mhi, IntPtr mask, IntPtr orientation, double delta1, double delta2, int apertureSize ) : void
cvCalcOpticalFlowBM ( IntPtr prev, IntPtr curr, Size blockSize, Size shiftSize, Size maxRange, bool usePrevious, IntPtr velx, IntPtr vely ) : void
cvCalcOpticalFlowFarneback ( IntPtr prev0, IntPtr next0, IntPtr flow0, double pyrScale, int levels, int winSize, int iterations, int polyN, double polySigma, CvEnum flags ) : void
cvCalcOpticalFlowHS ( IntPtr prev, IntPtr curr, bool usePrevious, IntPtr velx, IntPtr vely, double lambda, MCvTermCriteria criteria ) : void
cvCalcOpticalFlowLK ( IntPtr prev, IntPtr curr, Size winSize, IntPtr velx, IntPtr vely ) : void
cvCalcOpticalFlowPyrLK ( IntPtr prev, IntPtr curr, IntPtr prevPyr, IntPtr currPyr, [ prevFeatures, [ currFeatures, int count, Size winSize, int level, Byte status, float trackError, MCvTermCriteria criteria, CvEnum flags ) : void
cvCalcOpticalFlowPyrLK ( IntPtr prev, IntPtr curr, IntPtr prevPyr, IntPtr currPyr, float prevFeatures, float currFeatures, int count, Size winSize, int level, Byte status, float trackError, MCvTermCriteria criteria, CvEnum flags ) : void
cvCalcPGH ( IntPtr contour, IntPtr hist ) : void
cvCalcProbDensity ( IntPtr hist1, IntPtr hist2, IntPtr dstHist, double scale ) : void
cvCalcSubdivVoronoi2D ( IntPtr subdiv ) : void
cvCalibrateCamera2 ( IntPtr objectPoints, IntPtr imagePoints, IntPtr pointCounts, Size imageSize, IntPtr intrinsicMatrix, IntPtr distortionCoeffs, IntPtr rotationVectors, IntPtr translationVectors, CvEnum flags ) : double
cvCalibrationMatrixValues ( IntPtr calibMatr, int imgWidth, int imgHeight, double apertureWidth, double apertureHeight, double &fovx, double &fovy, double &focalLength, MCvPoint2D64f &principalPoint, double &pixelAspectRatio ) : void
cvCamShift ( IntPtr probImage, Rectangle window, MCvTermCriteria criteria, MCvConnectedComp &comp, MCvBox2D &box ) : int
cvCanny ( IntPtr image, IntPtr edges, double threshold1, double threshold2, int apertureSize ) : void
cvCheckContourConvexity ( IntPtr contour ) : int
cvCheckRange ( IntPtr arr, [ quiet, Point &pos, double minVal, double maxVal ) : bool
cvClearHist ( IntPtr hist ) : void
cvCompareHist ( IntPtr hist1, IntPtr hist2, CvEnum method ) : double
cvComputeCorrespondEpilines ( IntPtr points, int whichImage, IntPtr fundamentalMatrix, IntPtr correspondentLines ) : void
cvConDensInitSampleSet ( IntPtr condens, IntPtr lowerBound, IntPtr upperBound ) : void
cvConDensUpdateByTime ( IntPtr condens ) : void
cvContourArea ( IntPtr contour, MCvSlice slice, int oriented ) : double
cvContourFromContourTree ( IntPtr tree, IntPtr storage, MCvTermCriteria criteria ) : IntPtr
cvConvertPointsHomogeneous ( IntPtr src, IntPtr dst ) : void
cvConvexHull2 ( IntPtr input, IntPtr hullStorage, CvEnum orientation, int returnPoints ) : IntPtr
cvConvexityDefects ( IntPtr contour, IntPtr convexhull, IntPtr storage ) : IntPtr
cvCopyHist ( IntPtr src, IntPtr &dst ) : void
cvCopyMakeBorder ( IntPtr src, IntPtr dst, Point offset, CvEnum bordertype, MCvScalar value ) : void
cvCornerHarris ( IntPtr image, IntPtr harrisResponce, int blockSize, int apertureSize, double k ) : void
cvCreateBGCodeBookModel ( ) : IntPtr
cvCreateCameraCapture ( int index ) : IntPtr
cvCreateConDensation ( int dynamParams, int measureParams, int sampleCount ) : IntPtr
cvCreateContourTree ( IntPtr contour, IntPtr storage, double threshold ) : IntPtr
cvCreateFGDStatModel ( IntPtr image, IntPtr param ) : IntPtr
cvCreateFGDStatModel ( IntPtr firstFrame, MCvFGDStatModelParams &parameters ) : IntPtr
cvCreateFileCapture ( [ filename ) : IntPtr
cvCreateGaussianBGModel ( IntPtr image, IntPtr param ) : IntPtr
cvCreateGaussianBGModel ( IntPtr image, MCvGaussBGStatModelParams &parameters ) : IntPtr
cvCreateHist ( int dims, [ sizes, CvEnum type, [ ranges, int uniform ) : IntPtr
cvCreateKDTree ( IntPtr desc ) : IntPtr
cvCreateKalman ( int dynamParams, int measureParams, int controlParams ) : IntPtr
cvCreatePOSITObject ( float points3D, int pointCount ) : IntPtr
cvCreateSpillTree ( IntPtr desc, int naive, double rho, double tau ) : IntPtr
cvCreateStereoBMState ( CvEnum type, int numberOfDisparities ) : IntPtr
cvCreateStereoGCState ( int numberOfDisparities, int maxIters ) : IntPtr
cvCreateStructuringElementEx ( int cols, int rows, int anchorX, int anchorY, CvEnum shape, IntPtr values ) : IntPtr
cvCreateSubdiv2D ( int subdivType, int headerSize, int vtxSize, int quadedgeSize, IntPtr storage ) : IntPtr
cvCreateVideoWriter ( [ filename, int fourcc, double fps, System frameSize, int isColor ) : IntPtr
cvCvtColor ( IntPtr src, IntPtr dst, CvEnum code ) : void
cvDestroyWindow ( [ name ) : void
cvDilate ( IntPtr src, IntPtr dst, IntPtr element, int iterations ) : void
cvDistTransform ( IntPtr src, IntPtr dst, CvEnum distanceType, int maskSize, float userMask, IntPtr labels ) : void
cvDrawChessboardCorners ( IntPtr image, Size patternSize, IntPtr corners, int count, int patternWasFound ) : void
cvDrawChessboardCorners ( IntPtr image, Size patternSize, [ corners, int count, int patternWasFound ) : void
cvEigenDecomposite ( IntPtr obj, int eigenvecCount, IntPtr eigInput, CvEnum ioFlags, IntPtr userData, IntPtr avg, float coeffs ) : void
cvEigenProjection ( IntPtr inputVecs, int eigenvecCount, CvEnum ioFlags, IntPtr userdata, float coeffs, IntPtr avg, IntPtr proj ) : void
cvEndFindContours ( IntPtr &scanner ) : IntPtr
cvEqualizeHist ( IntPtr src, IntPtr dst ) : void
cvErode ( IntPtr src, IntPtr dst, IntPtr element, int iterations ) : void
cvEstimateRigidTransform ( IntPtr A, IntPtr B, IntPtr M, [ fullAffine ) : bool
cvExtractSURF ( IntPtr image, IntPtr mask, IntPtr &keypoints, IntPtr &descriptors, IntPtr storage, MCvSURFParams parameters, int useProvidedKeyPoints ) : void
cvFilter2D ( IntPtr src, IntPtr dst, IntPtr kernel, Point anchor ) : void
cvFindChessboardCorners ( IntPtr image, Size patternSize, IntPtr corners, int &cornerCount, CvEnum flags ) : int
cvFindContours ( IntPtr image, IntPtr storage, IntPtr &firstContour, int headerSize, CvEnum mode, CvEnum method, Point offset ) : int
cvFindCornerSubPix ( IntPtr image, IntPtr corners, int count, Size win, Size zeroZone, MCvTermCriteria criteria ) : void
cvFindCornerSubPix ( IntPtr image, [ corners, int count, Size win, Size zeroZone, MCvTermCriteria criteria ) : void
cvFindExtrinsicCameraParams2 ( IntPtr objectPoints, IntPtr imagePoints, IntPtr intrinsicMatrix, IntPtr distortionCoeffs, IntPtr rotationVector, IntPtr translationVector, int useExtrinsicGuess ) : void
cvFindFeatures ( IntPtr tr, IntPtr desc, IntPtr results, IntPtr dist, int k, int emax ) : void
cvFindFeaturesBoxed ( IntPtr tr, IntPtr boundsMin, IntPtr boundsMax, IntPtr results ) : void
cvFindFundamentalMat ( IntPtr points1, IntPtr points2, IntPtr fundamentalMatrix, CvEnum method, double param1, double param2, IntPtr status ) : int
cvFindHomography ( IntPtr srcPoints, IntPtr dstPoints, IntPtr homography, CvEnum method, double ransacReprojThreshold, IntPtr mask ) : bool
cvFindNearestPoint2D ( IntPtr subdiv, PointF pt ) : IntPtr
cvFindNextContour ( IntPtr scanner ) : IntPtr
cvFindStereoCorrespondence ( IntPtr leftImage, IntPtr rightImage, int mode, IntPtr depthImage, int maxDisparity, double param1, double param2, double param3, double param4, double param5 ) : void
cvFindStereoCorrespondenceBM ( IntPtr left, IntPtr right, IntPtr disparity, IntPtr state ) : void
cvFindStereoCorrespondenceBM ( IntPtr left, IntPtr right, IntPtr disparity, MCvStereoBMState &state ) : void
cvFindStereoCorrespondenceGC ( IntPtr left, IntPtr right, IntPtr dispLeft, IntPtr dispRight, IntPtr state, int useDisparityGuess ) : void
cvFindStereoCorrespondenceGC ( IntPtr left, IntPtr right, IntPtr dispLeft, IntPtr dispRight, MCvStereoGCState &state, int useDisparityGuess ) : void
cvFitEllipse2 ( IntPtr points ) : MCvBox2D
cvFitLine ( IntPtr points, CvEnum distType, double param, double reps, double aeps, [ line ) : void
cvFloodFill ( IntPtr src, Point seedPoint, MCvScalar newVal, MCvScalar loDiff, MCvScalar upDiff, MCvConnectedComp &comp, int flags, IntPtr mask ) : void
cvGetAffineTransform ( IntPtr src, IntPtr dst, IntPtr mapMatrix ) : IntPtr
cvGetAffineTransform ( PointF src, PointF dst, IntPtr mapMatrix ) : IntPtr
cvGetCaptureDomain ( IntPtr capture ) : int
cvGetCaptureProperty ( IntPtr capture, CvEnum prop ) : double
cvGetCentralMoment ( MCvMoments &moments, int xOrder, int yOrder ) : double
cvGetHuMoments ( MCvMoments &moments, MCvHuMoments &huMoments ) : void
cvGetMinMaxHistValue ( IntPtr hist, float &minValue, float &maxValue, int minIdx, int maxIdx ) : void
cvGetNormalizedCentralMoment ( MCvMoments &moments, int xOrder, int yOrder ) : double
cvGetOpenniCaptureContext ( IntPtr capture ) : IntPtr
cvGetPerspectiveTransform ( IntPtr src, IntPtr dst, IntPtr mapMatrix ) : IntPtr
cvGetPerspectiveTransform ( PointF src, PointF dst, IntPtr mapMatrix ) : IntPtr
cvGetQuadrangleSubPix ( IntPtr src, IntPtr dst, IntPtr mapMatrix ) : void
cvGetRectSubPix ( IntPtr src, IntPtr dst, PointF center ) : void
cvGetSpatialMoment ( MCvMoments &moments, int xOrder, int yOrder ) : double
cvGetStarKeypoints ( IntPtr img, IntPtr storage, MCvStarDetectorParams param ) : IntPtr
cvGoodFeaturesToTrack ( IntPtr image, IntPtr eigImage, IntPtr tempImage, IntPtr corners, int &cornerCount, double qualityLevel, double minDistance, IntPtr mask, int blockSize, int useHarris, double k ) : void
cvGrabFrame ( IntPtr capture ) : bool
cvHaarDetectObjects ( IntPtr image, IntPtr cascade, IntPtr storage, double scaleFactor, int minNeighbors, CvEnum flags, Size minSize, Size maxSize ) : IntPtr
cvHoughCircles ( IntPtr image, IntPtr circleStorage, CvEnum method, double dp, double minDist, double param1, double param2, int minRadius, int maxRadius ) : IntPtr
cvHoughLines2 ( IntPtr image, IntPtr lineStorage, CvEnum method, double rho, double theta, int threshold, double param1, double param2 ) : IntPtr
cvInitSubdivDelaunay2D ( IntPtr subdiv, Rectangle rect ) : void
cvInitUndistortMap ( IntPtr intrinsicMatrix, IntPtr distortionCoeffs, IntPtr mapx, IntPtr mapy ) : void
cvInitUndistortRectifyMap ( IntPtr cameraMatrix, IntPtr distCoeffs, IntPtr R, IntPtr newCameraMatrix, IntPtr mapx, IntPtr mapy ) : void
cvInpaint ( IntPtr src, IntPtr mask, IntPtr dst, double inpaintRadius, CvEnum flags ) : void
cvIntegral ( IntPtr image, IntPtr sum, IntPtr sqsum, IntPtr tiltedSum ) : void
cvKalmanCorrect ( IntPtr kalman, IntPtr measurement ) : IntPtr
cvKalmanCorrect ( MCvKalman &kalman, IntPtr measurement ) : IntPtr
cvKalmanPredict ( IntPtr kalman, IntPtr control ) : IntPtr
cvKalmanPredict ( MCvKalman &kalman, IntPtr control ) : IntPtr
cvLaplace ( IntPtr src, IntPtr dst, int apertureSize ) : void
cvLatentSvmDetectObjects ( IntPtr image, IntPtr detector, IntPtr storage, float overlapThreshold, int numThreads ) : IntPtr
cvLinearPolar ( IntPtr src, IntPtr dst, PointF center, double maxRadius, int flags ) : void
cvLoadImage ( [ filename, CvEnum loadType ) : IntPtr
cvLoadLatentSvmDetector ( [ filename ) : IntPtr
cvLogPolar ( IntPtr src, IntPtr dst, PointF center, double M, int flags ) : void
cvMakeHistHeaderForArray ( int dims, [ sizes, IntPtr hist, IntPtr data, [ ranges, int uniform ) : IntPtr
cvMatCopyToCvArr ( IntPtr mat, IntPtr cvArray ) : void
cvMatCreate ( ) : IntPtr
cvMatGetSize ( IntPtr mat ) : Size
cvMatRelease ( IntPtr &mat ) : void
cvMatchContourTrees ( IntPtr tree1, IntPtr tree2, CvEnum method, double threshold ) : double
cvMatchShapes ( IntPtr object1, IntPtr object2, CvEnum method, double parameter ) : double
cvMatchTemplate ( IntPtr image, IntPtr templ, IntPtr result, CvEnum method ) : void
cvMaxRect ( Rectangle &rect1, Rectangle &rect2 ) : Rectangle
cvMeanShift ( IntPtr probImage, Rectangle window, MCvTermCriteria criteria, MCvConnectedComp &comp ) : int
cvMinAreaRect2 ( IntPtr points, IntPtr storage ) : MCvBox2D
cvMinEnclosingCircle ( IntPtr points, PointF &center, float &radius ) : bool
cvMoments ( IntPtr arr, MCvMoments &moments, int binary ) : void
cvMorphologyEx ( IntPtr src, IntPtr dst, IntPtr temp, IntPtr element, CvEnum operation, int iterations ) : void
cvMultiplyAcc ( IntPtr image1, IntPtr image2, IntPtr acc, IntPtr mask ) : void
cvNormalizeHist ( IntPtr hist, double factor ) : void
cvPOSIT ( IntPtr positObject, IntPtr imagePoints, double focalLength, MCvTermCriteria criteria, IntPtr rotationMatrix, IntPtr translationVector ) : void
cvPOSIT ( IntPtr positObject, float imagePoints, double focalLength, MCvTermCriteria criteria, float rotationMatrix, float translationVector ) : void
cvPointPolygonTest ( IntPtr contour, PointF pt, int measureDist ) : double
cvProjectPoints2 ( IntPtr objectPoints, IntPtr rotationVector, IntPtr translationVector, IntPtr intrinsicMatrix, IntPtr distortionCoeffs, IntPtr imagePoints, IntPtr dpdrot, IntPtr dpdt, IntPtr dpdf, IntPtr dpdc, IntPtr dpddist, double aspectRatio ) : void
cvPyrDown ( IntPtr src, IntPtr dst, CvEnum filter ) : void
cvPyrMeanShiftFiltering ( IntPtr src, IntPtr dst, double sp, double sr, int max_level, MCvTermCriteria termcrit ) : void
cvPyrSegmentation ( IntPtr src, IntPtr dst, IntPtr storage, IntPtr &comp, int level, double threshold1, double threshold2 ) : void
cvPyrUp ( IntPtr src, IntPtr dst, CvEnum filter ) : void
cvQueryFrame ( IntPtr capture ) : IntPtr
cvReleaseBGCodeBookModel ( IntPtr &model ) : void
cvReleaseBGStatModel ( IntPtr &bgModel ) : void
cvReleaseCapture ( IntPtr &capture ) : void
cvReleaseConDensation ( IntPtr &condens ) : void
cvReleaseFeatureTree ( IntPtr tr ) : void
cvReleaseHaarClassifierCascade ( IntPtr &cascade ) : void
cvReleaseHist ( IntPtr &hist ) : void
cvReleaseKalman ( IntPtr &kalman ) : void
cvReleaseLatentSvmDetector ( IntPtr &detector ) : void
cvReleasePOSITObject ( IntPtr &positObject ) : void
cvReleaseStereoBMState ( IntPtr &state ) : void
cvReleaseStereoGCState ( IntPtr &state ) : void
cvReleaseStructuringElement ( IntPtr &ppElement ) : void
cvReleaseVideoWriter ( IntPtr &writer ) : void
cvRemap ( IntPtr src, IntPtr dst, IntPtr mapx, IntPtr mapy, int flags, MCvScalar fillval ) : void
cvReprojectImageTo3D ( IntPtr disparity, IntPtr image3D, IntPtr Q ) : void
cvResize ( IntPtr src, IntPtr dst, CvEnum interpolation ) : void
cvRetrieveFrame ( IntPtr capture, int streamIdx ) : IntPtr
cvRodrigues2 ( IntPtr src, IntPtr dst, IntPtr jacobian ) : bool
cvRunningAvg ( IntPtr image, IntPtr acc, double alpha, IntPtr mask ) : void
cvSURFParams ( double hessianThreshold, int extended ) : SURFDetector
cvSampleLine ( IntPtr image, Point pt1, Point pt2, IntPtr buffer, CvEnum connectivity ) : int
cvSaveImage ( [ filename, IntPtr image, IntPtr parameters ) : bool
cvSegmentMotion ( IntPtr mhi, IntPtr segMask, IntPtr storage, double timestamp, double segThresh ) : IntPtr
cvSetCaptureProperty ( IntPtr capture, CvEnum propertyId, double value ) : void
cvShowImage ( [ name, IntPtr image ) : void
cvSmooth ( IntPtr src, IntPtr dst, CvEnum type, int param1, int param2, double param3, double param4 ) : void
cvSnakeImage ( IntPtr image, IntPtr points, int length, [ alpha, [ beta, [ gamma, int coeffUsage, Size win, MCvTermCriteria criteria, int calcGradient ) : void
cvSnakeImage ( IntPtr image, [ points, int length, [ alpha, [ beta, [ gamma, int coeffUsage, Size win, MCvTermCriteria criteria, int calcGradient ) : void
cvSobel ( IntPtr src, IntPtr dst, int xorder, int yorder, int apertureSize ) : void
cvSqrt ( IntPtr src, IntPtr dst ) : void
cvSquareAcc ( IntPtr image, IntPtr sqsum, IntPtr mask ) : void
cvStartFindContours ( IntPtr image, IntPtr storage, int headerSize, CvEnum mode, CvEnum method, Point offset ) : IntPtr
cvStereoCalibrate ( IntPtr objectPoints, IntPtr imagePoints1, IntPtr imagePoints2, IntPtr pointCounts, IntPtr cameraMatrix1, IntPtr distCoeffs1, IntPtr cameraMatrix2, IntPtr distCoeffs2, Size imageSize, IntPtr R, IntPtr T, IntPtr E, IntPtr F, MCvTermCriteria termCrit, CvEnum flags ) : double
cvStereoRectify ( IntPtr cameraMatrix1, IntPtr cameraMatrix2, IntPtr distCoeffs1, IntPtr distCoeffs2, Size imageSize, IntPtr R, IntPtr T, IntPtr R1, IntPtr R2, IntPtr P1, IntPtr P2, IntPtr Q, CvEnum flags, double alpha, Size newImageSize, Rectangle &validPixROI1, Rectangle &validPixROI2 ) : void
cvStereoRectifyUncalibrated ( IntPtr points1, IntPtr points2, IntPtr F, Size imageSize, IntPtr H1, IntPtr H2, double threshold ) : int
cvSubdiv2DLocate ( IntPtr subdiv, PointF pt, IntPtr &edge, IntPtr &vertex ) : CvEnum.Subdiv2DPointLocationType
cvSubdivDelaunay2DInsert ( IntPtr subdiv, PointF pt ) : IntPtr
cvSubstituteContour ( IntPtr scanner, IntPtr newContour ) : void
cvThreshHist ( IntPtr hist, double threshold ) : void
cvThreshold ( IntPtr src, IntPtr dst, double threshold, double maxValue, CvEnum thresholdType ) : double
cvUndistort2 ( IntPtr src, IntPtr dst, IntPtr intrinsicMatrix, IntPtr distortionCoeffs, IntPtr newIntrinsicMatrix ) : void
cvUndistortPoints ( IntPtr src, IntPtr dst, IntPtr camera_matrix, IntPtr dist_coeffs, IntPtr R, IntPtr P ) : void
cvUpdateBGStatModel ( IntPtr currentFrame, IntPtr bgModel, double learningRate ) : int
cvUpdateMotionHistory ( IntPtr silhouette, IntPtr mhi, double timestamp, double duration ) : void
cvWaitKey ( int delay ) : int
cvWarpAffine ( IntPtr src, IntPtr dst, IntPtr mapMatrix, int flags, MCvScalar fillval ) : void
cvWarpPerspective ( IntPtr src, IntPtr dst, IntPtr mapMatrix, int flags, MCvScalar fillval ) : void
cvWatershed ( IntPtr image, IntPtr markers ) : void
cvWriteFrame ( IntPtr writer, IntPtr image ) : bool
cvbCvBlobGetContour ( IntPtr blob, IntPtr contour ) : void
cvbCvBlobGetLabel ( IntPtr blob ) : uint
cvbCvBlobGetMoment ( IntPtr blob, Emgu &moments ) : void
cvbCvBlobGetRect ( IntPtr blob, Rectangle &rect ) : void
cvbCvBlobMeanColor ( IntPtr blob, IntPtr imgLabel, IntPtr img ) : MCvScalar
cvbCvFilterLabels ( IntPtr imgIn, IntPtr imgOut, IntPtr blobs ) : void
cvbCvLabel ( IntPtr img, IntPtr imgOut, IntPtr blobs ) : uint
cvbCvRenderBlobs ( IntPtr labelMask, IntPtr blobs, IntPtr imgSource, IntPtr imgDest, Cvb mode, double alpha ) : void
icvSubdiv2DCheck ( IntPtr subdiv ) : bool
tbbTaskSchedulerInit ( ) : IntPtr
tbbTaskSchedulerRelease ( IntPtr &scheduler ) : void
zlib_compress2 ( IntPtr dataCompressed, int &sizeDataCompressed, IntPtr dataOriginal, int sizeDataOriginal, int compressionLevel ) : void
zlib_compress_bound ( int length ) : int
zlib_uncompress ( IntPtr dataUncompressed, int &sizeDataUncompressed, IntPtr compressedData, int sizeDataCompressed ) : void

Описание методов

CV_FOURCC() публичный статический Метод

Generate 4-character code of codec used to compress the frames. For example, CV_FOURCC('P','I','M','1') is MPEG-1 codec, CV_FOURCC('M','J','P','G') is motion-jpeg codec etc.
public static CV_FOURCC ( char c1, char c2, char c3, char c4 ) : int
c1 char
c2 char
c3 char
c4 char
Результат int

CV_MAKETYPE() публичный статический Метод

This function performs the same as CV_MAKETYPE macro
public static CV_MAKETYPE ( int depth, int cn ) : int
depth int The type of depth
cn int The number of channels
Результат int

GetModuleFormatString() публичный статический Метод

Get the module format string.
public static GetModuleFormatString ( ) : String
Результат String

LoadUnmanagedModules() публичный статический Метод

Attemps to load opencv modules from the specific location
If loadDirectory is null, the default location on windows is the dll's path appended by either "x64" or "x86", depends on the applications current mode.
public static LoadUnmanagedModules ( String loadDirectory ) : bool
loadDirectory String The directory where the unmanaged modules will be loaded. If it is null, the default location will be used.
Результат bool

cvBoundingRect() публичный статический Метод

Returns the up-right bounding rectangle for 2d point set
public static cvBoundingRect ( IntPtr points, bool update ) : Rectangle
points IntPtr Either a 2D point set, represented as a sequence (CvSeq*, CvContour*) or vector (CvMat*) of points, or 8-bit single-channel mask image (CvMat*, IplImage*), in which non-zero pixels are considered
update bool The update flag. Here is list of possible combination of the flag values and type of contour: /// points is CvContour*, update=false: the bounding rectangle is not calculated, but it is read from rect field of the contour header. /// points is CvContour*, update=true: the bounding rectangle is calculated and written to rect field of the contour header. For example, this mode is used by cvFindContours. /// points is CvSeq* or CvMat*: update is ignored, the bounding rectangle is calculated and returned. ///
Результат Rectangle

cvCalcArrHist() публичный статический Метод

Calculates the histogram of one or more single-channel images. The elements of a tuple that is used to increment a histogram bin are taken at the same location from the corresponding input images.
public static cvCalcArrHist ( IntPtr image, IntPtr hist, bool accumulate, IntPtr mask ) : void
image IntPtr Source images (though, you may pass CvMat** as well), all are of the same size and type
hist IntPtr Pointer to the histogram
accumulate bool Accumulation flag. If it is set, the histogram is not cleared in the beginning. This feature allows user to compute a single histogram from several images, or to update the histogram online
mask IntPtr The operation mask, determines what pixels of the source images are counted
Результат void

cvCalcEigenObjects() публичный статический Метод

Calculates orthonormal eigen basis and the averaged object for a group of the input objects.
public static cvCalcEigenObjects ( IntPtr input, MCvTermCriteria &calcLimit, IntPtr eigVecs, float eigVals, IntPtr avg ) : void
input IntPtr Pointer to the array of IplImage input objects
calcLimit MCvTermCriteria Criteria that determine when to stop calculation of eigen objects. Depending on the parameter calcLimit, calculations are finished either after first calcLimit.max_iter dominating eigen objects are retrieved or if the ratio of the current eigenvalue to the largest eigenvalue comes down to calcLimit.epsilon threshold. The value calcLimit -> type must be CV_TERMCRIT_NUMB, CV_TERMCRIT_EPS, or CV_TERMCRIT_NUMB | CV_TERMCRIT_EPS . The function returns the real values calcLimit->max_iter and calcLimit->epsilon
eigVecs IntPtr Pointer either to the array of eigen objects
eigVals float Pointer to the eigenvalues array in the descending order; may be NULL
avg IntPtr Averaged object
Результат void

cvCalcHist() публичный статический Метод

Calculates the histogram of one or more single-channel images. The elements of a tuple that is used to increment a histogram bin are taken at the same location from the corresponding input images.
public static cvCalcHist ( IntPtr image, IntPtr hist, bool accumulate, IntPtr mask ) : void
image IntPtr Source images (though, you may pass CvMat** as well), all are of the same size and type
hist IntPtr Pointer to the histogram
accumulate bool Accumulation flag. If it is set, the histogram is not cleared in the beginning. This feature allows user to compute a single histogram from several images, or to update the histogram online
mask IntPtr The operation mask, determines what pixels of the source images are counted
Результат void

cvContourPerimeter() публичный статический Метод

Find the perimeter of the contour
public static cvContourPerimeter ( IntPtr contour ) : double
contour IntPtr Pointer to the contour
Результат double

cvCreateHist() публичный статический Метод

Creates a histogram of the specified size and returns the pointer to the created histogram. If the array ranges is 0, the histogram bin ranges must be specified later via The function cvSetHistBinRanges, though cvCalcHist and cvCalcBackProject may process 8-bit images without setting bin ranges, they assume equally spaced in 0..255 bins
public static cvCreateHist ( int dims, [ sizes, CvEnum type, [ ranges, bool uniform ) : IntPtr
dims int Number of histogram dimensions
sizes [ Array of histogram dimension sizes
type CvEnum Histogram representation format: CV_HIST_ARRAY means that histogram data is represented as an multi-dimensional dense array CvMatND; CV_HIST_SPARSE means that histogram data is represented as a multi-dimensional sparse array CvSparseMat
ranges [ Array of ranges for histogram bins. Its meaning depends on the uniform parameter value. The ranges are used for when histogram is calculated or backprojected to determine, which histogram bin corresponds to which value/tuple of values from the input image[s].
uniform bool /// Uniformity flag; /// if true, the histogram has evenly spaced bins and for every 0<=i<cDims ranges[i] is array of two numbers: lower and upper boundaries for the i-th histogram dimension. /// The whole range [lower,upper] is split then into dims[i] equal parts to determine i-th input tuple value ranges for every histogram bin. /// And if uniform=false, then i-th element of ranges array contains dims[i]+1 elements: lower0, upper0, lower1, upper1 == lower2, ..., upperdims[i]-1, where lowerj and upperj are lower and upper boundaries of i-th input tuple value for j-th bin, respectively. /// In either case, the input values that are beyond the specified range for a histogram bin, are not counted by cvCalcHist and filled with 0 by cvCalcBackProject ///
Результат IntPtr

cvCreateSubdivDelaunay2D() публичный статический Метод

Creates an empty Delaunay subdivision, where 2d points can be added further using function cvSubdivDelaunay2DInsert. All the points to be added must be within the specified rectangle, otherwise a runtime error will be raised.
public static cvCreateSubdivDelaunay2D ( Rectangle rect, IntPtr storage ) : IntPtr
rect Rectangle Rectangle that includes all the 2d points that are to be added to subdivision.
storage IntPtr Container for subdivision
Результат IntPtr

cvCreateVideoWriter() публичный статический Метод

Creates video writer structure.
public static cvCreateVideoWriter ( String filename, int fourcc, double fps, System frameSize, bool isColor ) : IntPtr
filename String Name of the output video file.
fourcc int 4-character code of codec used to compress the frames. For example, CV_FOURCC('P','I','M','1') is MPEG-1 codec, CV_FOURCC('M','J','P','G') is motion-jpeg codec etc.
fps double Framerate of the created video stream.
frameSize System Size of video frames.
isColor bool If it is true, the encoder will expect and encode color frames, otherwise it will work with grayscale frames
Результат IntPtr

cvEigenDecomposite() публичный статический Метод

Calculates all decomposition coefficients for the input object using the previously calculated eigen objects basis and the averaged object
public static cvEigenDecomposite ( IntPtr obj, IntPtr eigInput, IntPtr avg ) : float[]
obj IntPtr Input object (Pointer to IplImage)
eigInput IntPtr Pointer to the array of IplImage input objects
avg IntPtr Averaged object (Pointer to IplImage)
Результат float[]

cvEigenProjection() публичный статический Метод

Calculates an object projection to the eigen sub-space or, in other words, restores an object using previously calculated eigen objects basis, averaged object, and decomposition coefficients of the restored object.
public static cvEigenProjection ( IntPtr inputVecs, float coeffs, IntPtr avg, IntPtr proj ) : void
inputVecs IntPtr Pointer to either an array of IplImage input objects or to a callback function, depending on io_flags
coeffs float Previously calculated decomposition coefficients
avg IntPtr Average vector
proj IntPtr Projection to the eigen sub-space
Результат void

cvFloodFill() публичный статический Метод

Fills a connected component with given color.
public static cvFloodFill ( IntPtr src, Point seedPoint, MCvScalar newVal, MCvScalar loDiff, MCvScalar upDiff, MCvConnectedComp &comp, CvEnum connectivity, CvEnum flags, IntPtr mask ) : void
src IntPtr Input 1- or 3-channel, 8-bit or floating-point image. It is modified by the function unless CV_FLOODFILL_MASK_ONLY flag is set.
seedPoint Point The starting point.
newVal MCvScalar New value of repainted domain pixels.
loDiff MCvScalar Maximal lower brightness/color difference /// between the currently observed pixel and one of its neighbor belong to the component /// or seed pixel to add the pixel to component. /// In case of 8-bit color images it is packed value.
upDiff MCvScalar Maximal upper brightness/color difference /// between the currently observed pixel and one of its neighbor belong to the component /// or seed pixel to add the pixel to component. /// In case of 8-bit color images it is packed value.
comp MCvConnectedComp Pointer to structure the function fills with the information about the repainted domain.
connectivity CvEnum The connectivity of flood fill
flags CvEnum The flood fill types
mask IntPtr Operation mask, /// should be singe-channel 8-bit image, 2 pixels wider and 2 pixels taller than image. /// If not IntPtr.Zero, the function uses and updates the mask, so user takes responsibility of initializing mask content. /// Floodfilling can't go across non-zero pixels in the mask, for example, an edge detector output can be used as a mask to stop filling at edges. /// Or it is possible to use the same mask in multiple calls to the function to make sure the filled area do not overlap. /// Note: because mask is larger than the filled image, pixel in mask that corresponds to (x,y) pixel in image will have coordinates (x+1,y+1).
Результат void

cvNamedWindow() публичный статический Метод

Creates a window which can be used as a placeholder for images and trackbars. Created windows are reffered by their names. If the window with such a name already exists, the function does nothing.
public static cvNamedWindow ( String name ) : int
name String Name of the window which is used as window identifier and appears in the window caption
Результат int

cvPointPolygonTest() публичный статический Метод

Determines whether the point is inside contour, outside, or lies on an edge (or coinsides with a vertex). It returns positive, negative or zero value, correspondingly
public static cvPointPolygonTest ( IntPtr contour, PointF pt, bool measureDist ) : double
contour IntPtr Input contour
pt PointF The point tested against the contour
measureDist bool If true, the function estimates distance from the point to the nearest contour edge
Результат double

cvSnakeImage() публичный статический Метод

Updates snake in order to minimize its total energy that is a sum of internal energy that depends on contour shape (the smoother contour is, the smaller internal energy is) and external energy that depends on the energy field and reaches minimum at the local energy extremums that correspond to the image edges in case of image gradient.
public static cvSnakeImage ( IntPtr image, IntPtr points, int length, float alpha, float beta, float gamma, int coeffUsage, Size win, MCvTermCriteria criteria, bool calcGradient ) : void
image IntPtr The source image or external energy field
points IntPtr Seq points (snake).
length int Number of points in the contour
alpha float Weight[s] of continuity energy, single float or array of length floats, one per each contour point
beta float Weight[s] of curvature energy, similar to alpha
gamma float Weight[s] of image energy, similar to alpha
coeffUsage int Variant of usage of the previous three parameters: /// CV_VALUE indicates that each of alpha, beta, gamma is a pointer to a single value to be used for all points; /// CV_ARRAY indicates that each of alpha, beta, gamma is a pointer to an array of coefficients different for all the points of the snake. All the arrays must have the size equal to the contour size. ///
win Size Size of neighborhood of every point used to search the minimum, both win.width and win.height must be odd
criteria MCvTermCriteria Termination criteria
calcGradient bool /// Gradient flag. If true, the function calculates gradient magnitude for every image pixel and consideres it as the energy field, /// otherwise the input image itself is considered ///
Результат void