OpenCV for Unity
2.2.8
Enox Software / Please refer to OpenCV official document(http://docs.opencv.org/3.4.1/index.html) for the details of the argument of the method.
|
Static Public Member Functions | |
static Mat | getAffineTransform (MatOfPoint2f src, MatOfPoint2f dst) |
static Mat | getDefaultNewCameraMatrix (Mat cameraMatrix, Size imgsize, bool centerPrincipalPoint) |
static Mat | getDefaultNewCameraMatrix (Mat cameraMatrix) |
static Mat | getGaborKernel (Size ksize, double sigma, double theta, double lambd, double gamma, double psi, int ktype) |
static Mat | getGaborKernel (Size ksize, double sigma, double theta, double lambd, double gamma) |
static Mat | getGaussianKernel (int ksize, double sigma, int ktype) |
static Mat | getGaussianKernel (int ksize, double sigma) |
static Mat | getPerspectiveTransform (Mat src, Mat dst) |
static Mat | getRotationMatrix2D (Point center, double angle, double scale) |
static Mat | getStructuringElement (int shape, Size ksize, Point anchor) |
static Mat | getStructuringElement (int shape, Size ksize) |
static Moments | moments (Mat array, bool binaryImage) |
static Moments | moments (Mat array) |
static Point | phaseCorrelate (Mat src1, Mat src2, Mat window, double[] response) |
static Point | phaseCorrelate (Mat src1, Mat src2) |
static CLAHE | createCLAHE (double clipLimit, Size tileGridSize) |
static CLAHE | createCLAHE () |
static LineSegmentDetector | createLineSegmentDetector (int _refine, double _scale, double _sigma_scale, double _quant, double _ang_th, double _log_eps, double _density_th, int _n_bins) |
static LineSegmentDetector | createLineSegmentDetector () |
static Rect | boundingRect (MatOfPoint points) |
static RotatedRect | fitEllipse (MatOfPoint2f points) |
static RotatedRect | fitEllipseAMS (Mat points) |
static RotatedRect | fitEllipseDirect (Mat points) |
static RotatedRect | minAreaRect (MatOfPoint2f points) |
static bool | clipLine (Rect imgRect, Point pt1, Point pt2) |
static bool | isContourConvex (MatOfPoint contour) |
static double | arcLength (MatOfPoint2f curve, bool closed) |
static double | compareHist (Mat H1, Mat H2, int method) |
static double | contourArea (Mat contour, bool oriented) |
static double | contourArea (Mat contour) |
static double | getFontScaleFromHeight (int fontFace, int pixelHeight, int thickness) |
static double | getFontScaleFromHeight (int fontFace, int pixelHeight) |
static double | matchShapes (Mat contour1, Mat contour2, int method, double parameter) |
static double | minEnclosingTriangle (Mat points, Mat triangle) |
static double | pointPolygonTest (MatOfPoint2f contour, Point pt, bool measureDist) |
static double | threshold (Mat src, Mat dst, double thresh, double maxval, int type) |
static float | initWideAngleProjMap (Mat cameraMatrix, Mat distCoeffs, Size imageSize, int destImageWidth, int m1type, Mat map1, Mat map2, int projType, double alpha) |
static float | initWideAngleProjMap (Mat cameraMatrix, Mat distCoeffs, Size imageSize, int destImageWidth, int m1type, Mat map1, Mat map2) |
static float | intersectConvexConvex (Mat _p1, Mat _p2, Mat _p12, bool handleNested) |
static float | intersectConvexConvex (Mat _p1, Mat _p2, Mat _p12) |
static float | EMD (Mat signature1, Mat signature2, int distType, Mat cost, Mat flow) |
static float | EMD (Mat signature1, Mat signature2, int distType) |
static int | connectedComponentsWithAlgorithm (Mat image, Mat labels, int connectivity, int ltype, int ccltype) |
static int | connectedComponents (Mat image, Mat labels, int connectivity, int ltype) |
static int | connectedComponents (Mat image, Mat labels) |
static int | connectedComponentsWithStatsWithAlgorithm (Mat image, Mat labels, Mat stats, Mat centroids, int connectivity, int ltype, int ccltype) |
static int | connectedComponentsWithStats (Mat image, Mat labels, Mat stats, Mat centroids, int connectivity, int ltype) |
static int | connectedComponentsWithStats (Mat image, Mat labels, Mat stats, Mat centroids) |
static int | floodFill (Mat image, Mat mask, Point seedPoint, Scalar newVal, Rect rect, Scalar loDiff, Scalar upDiff, int flags) |
static int | floodFill (Mat image, Mat mask, Point seedPoint, Scalar newVal) |
static int | rotatedRectangleIntersection (RotatedRect rect1, RotatedRect rect2, Mat intersectingRegion) |
static void | Canny (Mat dx, Mat dy, Mat edges, double threshold1, double threshold2, bool L2gradient) |
static void | Canny (Mat dx, Mat dy, Mat edges, double threshold1, double threshold2) |
static void | Canny (Mat image, Mat edges, double threshold1, double threshold2, int apertureSize, bool L2gradient) |
static void | Canny (Mat image, Mat edges, double threshold1, double threshold2) |
static void | GaussianBlur (Mat src, Mat dst, Size ksize, double sigmaX, double sigmaY, int borderType) |
static void | GaussianBlur (Mat src, Mat dst, Size ksize, double sigmaX, double sigmaY) |
static void | GaussianBlur (Mat src, Mat dst, Size ksize, double sigmaX) |
static void | HoughCircles (Mat image, Mat circles, int method, double dp, double minDist, double param1, double param2, int minRadius, int maxRadius) |
static void | HoughCircles (Mat image, Mat circles, int method, double dp, double minDist) |
static void | HoughLines (Mat image, Mat lines, double rho, double theta, int threshold, double srn, double stn, double min_theta, double max_theta) |
static void | HoughLines (Mat image, Mat lines, double rho, double theta, int threshold) |
static void | HoughLinesP (Mat image, Mat lines, double rho, double theta, int threshold, double minLineLength, double maxLineGap) |
static void | HoughLinesP (Mat image, Mat lines, double rho, double theta, int threshold) |
static void | HoughLinesPointSet (Mat _point, Mat _lines, int lines_max, int threshold, double min_rho, double max_rho, double rho_step, double min_theta, double max_theta, double theta_step) |
static void | HuMoments (Moments m, Mat hu) |
static void | Laplacian (Mat src, Mat dst, int ddepth, int ksize, double scale, double delta, int borderType) |
static void | Laplacian (Mat src, Mat dst, int ddepth, int ksize, double scale, double delta) |
static void | Laplacian (Mat src, Mat dst, int ddepth) |
static void | Scharr (Mat src, Mat dst, int ddepth, int dx, int dy, double scale, double delta, int borderType) |
static void | Scharr (Mat src, Mat dst, int ddepth, int dx, int dy, double scale, double delta) |
static void | Scharr (Mat src, Mat dst, int ddepth, int dx, int dy) |
static void | Sobel (Mat src, Mat dst, int ddepth, int dx, int dy, int ksize, double scale, double delta, int borderType) |
static void | Sobel (Mat src, Mat dst, int ddepth, int dx, int dy, int ksize, double scale, double delta) |
static void | Sobel (Mat src, Mat dst, int ddepth, int dx, int dy) |
static void | accumulate (Mat src, Mat dst, Mat mask) |
static void | accumulate (Mat src, Mat dst) |
static void | accumulateProduct (Mat src1, Mat src2, Mat dst, Mat mask) |
static void | accumulateProduct (Mat src1, Mat src2, Mat dst) |
static void | accumulateSquare (Mat src, Mat dst, Mat mask) |
static void | accumulateSquare (Mat src, Mat dst) |
static void | accumulateWeighted (Mat src, Mat dst, double alpha, Mat mask) |
static void | accumulateWeighted (Mat src, Mat dst, double alpha) |
static void | adaptiveThreshold (Mat src, Mat dst, double maxValue, int adaptiveMethod, int thresholdType, int blockSize, double C) |
static void | applyColorMap (Mat src, Mat dst, Mat userColor) |
static void | applyColorMap (Mat src, Mat dst, int colormap) |
static void | approxPolyDP (MatOfPoint2f curve, MatOfPoint2f approxCurve, double epsilon, bool closed) |
static void | arrowedLine (Mat img, Point pt1, Point pt2, Scalar color, int thickness, int line_type, int shift, double tipLength) |
static void | arrowedLine (Mat img, Point pt1, Point pt2, Scalar color) |
static void | bilateralFilter (Mat src, Mat dst, int d, double sigmaColor, double sigmaSpace, int borderType) |
static void | bilateralFilter (Mat src, Mat dst, int d, double sigmaColor, double sigmaSpace) |
static void | blur (Mat src, Mat dst, Size ksize, Point anchor, int borderType) |
static void | blur (Mat src, Mat dst, Size ksize, Point anchor) |
static void | blur (Mat src, Mat dst, Size ksize) |
static void | boxFilter (Mat src, Mat dst, int ddepth, Size ksize, Point anchor, bool normalize, int borderType) |
static void | boxFilter (Mat src, Mat dst, int ddepth, Size ksize, Point anchor, bool normalize) |
static void | boxFilter (Mat src, Mat dst, int ddepth, Size ksize) |
static void | boxPoints (RotatedRect box, Mat points) |
static void | calcBackProject (List< Mat > images, MatOfInt channels, Mat hist, Mat dst, MatOfFloat ranges, double scale) |
static void | calcHist (List< Mat > images, MatOfInt channels, Mat mask, Mat hist, MatOfInt histSize, MatOfFloat ranges, bool accumulate) |
static void | calcHist (List< Mat > images, MatOfInt channels, Mat mask, Mat hist, MatOfInt histSize, MatOfFloat ranges) |
static void | circle (Mat img, Point center, int radius, Scalar color, int thickness, int lineType, int shift) |
static void | circle (Mat img, Point center, int radius, Scalar color, int thickness) |
static void | circle (Mat img, Point center, int radius, Scalar color) |
static void | convertMaps (Mat map1, Mat map2, Mat dstmap1, Mat dstmap2, int dstmap1type, bool nninterpolation) |
static void | convertMaps (Mat map1, Mat map2, Mat dstmap1, Mat dstmap2, int dstmap1type) |
static void | convexHull (MatOfPoint points, MatOfInt hull, bool clockwise) |
static void | convexHull (MatOfPoint points, MatOfInt hull) |
static void | convexityDefects (MatOfPoint contour, MatOfInt convexhull, MatOfInt4 convexityDefects) |
static void | cornerEigenValsAndVecs (Mat src, Mat dst, int blockSize, int ksize, int borderType) |
static void | cornerEigenValsAndVecs (Mat src, Mat dst, int blockSize, int ksize) |
static void | cornerHarris (Mat src, Mat dst, int blockSize, int ksize, double k, int borderType) |
static void | cornerHarris (Mat src, Mat dst, int blockSize, int ksize, double k) |
static void | cornerMinEigenVal (Mat src, Mat dst, int blockSize, int ksize, int borderType) |
static void | cornerMinEigenVal (Mat src, Mat dst, int blockSize, int ksize) |
static void | cornerMinEigenVal (Mat src, Mat dst, int blockSize) |
static void | cornerSubPix (Mat image, Mat corners, Size winSize, Size zeroZone, TermCriteria criteria) |
static void | createHanningWindow (Mat dst, Size winSize, int type) |
static void | cvtColor (Mat src, Mat dst, int code, int dstCn) |
static void | cvtColor (Mat src, Mat dst, int code) |
static void | cvtColorTwoPlane (Mat src1, Mat src2, Mat dst, int code) |
static void | demosaicing (Mat _src, Mat _dst, int code, int dcn) |
static void | demosaicing (Mat _src, Mat _dst, int code) |
static void | dilate (Mat src, Mat dst, Mat kernel, Point anchor, int iterations, int borderType, Scalar borderValue) |
static void | dilate (Mat src, Mat dst, Mat kernel, Point anchor, int iterations) |
static void | dilate (Mat src, Mat dst, Mat kernel) |
static void | distanceTransformWithLabels (Mat src, Mat dst, Mat labels, int distanceType, int maskSize, int labelType) |
static void | distanceTransformWithLabels (Mat src, Mat dst, Mat labels, int distanceType, int maskSize) |
static void | distanceTransform (Mat src, Mat dst, int distanceType, int maskSize, int dstType) |
static void | distanceTransform (Mat src, Mat dst, int distanceType, int maskSize) |
static void | drawContours (Mat image, List< MatOfPoint > contours, int contourIdx, Scalar color, int thickness, int lineType, Mat hierarchy, int maxLevel, Point offset) |
static void | drawContours (Mat image, List< MatOfPoint > contours, int contourIdx, Scalar color, int thickness) |
static void | drawContours (Mat image, List< MatOfPoint > contours, int contourIdx, Scalar color) |
static void | drawMarker (Mat img, Point position, Scalar color, int markerType, int markerSize, int thickness, int line_type) |
static void | drawMarker (Mat img, Point position, Scalar color) |
static void | ellipse (Mat img, Point center, Size axes, double angle, double startAngle, double endAngle, Scalar color, int thickness, int lineType, int shift) |
static void | ellipse (Mat img, Point center, Size axes, double angle, double startAngle, double endAngle, Scalar color, int thickness) |
static void | ellipse (Mat img, Point center, Size axes, double angle, double startAngle, double endAngle, Scalar color) |
static void | ellipse (Mat img, RotatedRect box, Scalar color, int thickness, int lineType) |
static void | ellipse (Mat img, RotatedRect box, Scalar color, int thickness) |
static void | ellipse (Mat img, RotatedRect box, Scalar color) |
static void | ellipse2Poly (Point center, Size axes, int angle, int arcStart, int arcEnd, int delta, MatOfPoint pts) |
static void | equalizeHist (Mat src, Mat dst) |
static void | erode (Mat src, Mat dst, Mat kernel, Point anchor, int iterations, int borderType, Scalar borderValue) |
static void | erode (Mat src, Mat dst, Mat kernel, Point anchor, int iterations) |
static void | erode (Mat src, Mat dst, Mat kernel) |
static void | fillConvexPoly (Mat img, MatOfPoint points, Scalar color, int lineType, int shift) |
static void | fillConvexPoly (Mat img, MatOfPoint points, Scalar color) |
static void | fillPoly (Mat img, List< MatOfPoint > pts, Scalar color, int lineType, int shift, Point offset) |
static void | fillPoly (Mat img, List< MatOfPoint > pts, Scalar color) |
static void | filter2D (Mat src, Mat dst, int ddepth, Mat kernel, Point anchor, double delta, int borderType) |
static void | filter2D (Mat src, Mat dst, int ddepth, Mat kernel, Point anchor, double delta) |
static void | filter2D (Mat src, Mat dst, int ddepth, Mat kernel) |
static void | findContours (Mat image, List< MatOfPoint > contours, Mat hierarchy, int mode, int method, Point offset) |
static void | findContours (Mat image, List< MatOfPoint > contours, Mat hierarchy, int mode, int method) |
static void | fitLine (Mat points, Mat line, int distType, double param, double reps, double aeps) |
static void | getDerivKernels (Mat kx, Mat ky, int dx, int dy, int ksize, bool normalize, int ktype) |
static void | getDerivKernels (Mat kx, Mat ky, int dx, int dy, int ksize) |
static void | getRectSubPix (Mat image, Size patchSize, Point center, Mat patch, int patchType) |
static void | getRectSubPix (Mat image, Size patchSize, Point center, Mat patch) |
static void | goodFeaturesToTrack (Mat image, MatOfPoint corners, int maxCorners, double qualityLevel, double minDistance, Mat mask, int blockSize, int gradientSize, bool useHarrisDetector, double k) |
static void | goodFeaturesToTrack (Mat image, MatOfPoint corners, int maxCorners, double qualityLevel, double minDistance, Mat mask, int blockSize, int gradientSize) |
static void | goodFeaturesToTrack (Mat image, MatOfPoint corners, int maxCorners, double qualityLevel, double minDistance, Mat mask, int blockSize, bool useHarrisDetector, double k) |
static void | goodFeaturesToTrack (Mat image, MatOfPoint corners, int maxCorners, double qualityLevel, double minDistance) |
static void | grabCut (Mat img, Mat mask, Rect rect, Mat bgdModel, Mat fgdModel, int iterCount, int mode) |
static void | grabCut (Mat img, Mat mask, Rect rect, Mat bgdModel, Mat fgdModel, int iterCount) |
static void | initUndistortRectifyMap (Mat cameraMatrix, Mat distCoeffs, Mat R, Mat newCameraMatrix, Size size, int m1type, Mat map1, Mat map2) |
static void | integral3 (Mat src, Mat sum, Mat sqsum, Mat tilted, int sdepth, int sqdepth) |
static void | integral3 (Mat src, Mat sum, Mat sqsum, Mat tilted) |
static void | integral2 (Mat src, Mat sum, Mat sqsum, int sdepth, int sqdepth) |
static void | integral2 (Mat src, Mat sum, Mat sqsum) |
static void | integral (Mat src, Mat sum, int sdepth) |
static void | integral (Mat src, Mat sum) |
static void | invertAffineTransform (Mat M, Mat iM) |
static void | line (Mat img, Point pt1, Point pt2, Scalar color, int thickness, int lineType, int shift) |
static void | line (Mat img, Point pt1, Point pt2, Scalar color, int thickness) |
static void | line (Mat img, Point pt1, Point pt2, Scalar color) |
static void | linearPolar (Mat src, Mat dst, Point center, double maxRadius, int flags) |
static void | logPolar (Mat src, Mat dst, Point center, double M, int flags) |
static void | matchTemplate (Mat image, Mat templ, Mat result, int method, Mat mask) |
static void | matchTemplate (Mat image, Mat templ, Mat result, int method) |
static void | medianBlur (Mat src, Mat dst, int ksize) |
static void | minEnclosingCircle (MatOfPoint2f points, Point center, float[] radius) |
static void | morphologyEx (Mat src, Mat dst, int op, Mat kernel, Point anchor, int iterations, int borderType, Scalar borderValue) |
static void | morphologyEx (Mat src, Mat dst, int op, Mat kernel, Point anchor, int iterations) |
static void | morphologyEx (Mat src, Mat dst, int op, Mat kernel) |
static void | polylines (Mat img, List< MatOfPoint > pts, bool isClosed, Scalar color, int thickness, int lineType, int shift) |
static void | polylines (Mat img, List< MatOfPoint > pts, bool isClosed, Scalar color, int thickness) |
static void | polylines (Mat img, List< MatOfPoint > pts, bool isClosed, Scalar color) |
static void | preCornerDetect (Mat src, Mat dst, int ksize, int borderType) |
static void | preCornerDetect (Mat src, Mat dst, int ksize) |
static void | putText (Mat img, string text, Point org, int fontFace, double fontScale, Scalar color, int thickness, int lineType, bool bottomLeftOrigin) |
static void | putText (Mat img, string text, Point org, int fontFace, double fontScale, Scalar color, int thickness) |
static void | putText (Mat img, string text, Point org, int fontFace, double fontScale, Scalar color) |
static void | pyrDown (Mat src, Mat dst, Size dstsize, int borderType) |
static void | pyrDown (Mat src, Mat dst, Size dstsize) |
static void | pyrDown (Mat src, Mat dst) |
static void | pyrMeanShiftFiltering (Mat src, Mat dst, double sp, double sr, int maxLevel, TermCriteria termcrit) |
static void | pyrMeanShiftFiltering (Mat src, Mat dst, double sp, double sr) |
static void | pyrUp (Mat src, Mat dst, Size dstsize, int borderType) |
static void | pyrUp (Mat src, Mat dst, Size dstsize) |
static void | pyrUp (Mat src, Mat dst) |
static void | rectangle (Mat img, Point pt1, Point pt2, Scalar color, int thickness, int lineType, int shift) |
static void | rectangle (Mat img, Point pt1, Point pt2, Scalar color, int thickness) |
static void | rectangle (Mat img, Point pt1, Point pt2, Scalar color) |
static void | remap (Mat src, Mat dst, Mat map1, Mat map2, int interpolation, int borderMode, Scalar borderValue) |
static void | remap (Mat src, Mat dst, Mat map1, Mat map2, int interpolation) |
static void | resize (Mat src, Mat dst, Size dsize, double fx, double fy, int interpolation) |
static void | resize (Mat src, Mat dst, Size dsize) |
static void | sepFilter2D (Mat src, Mat dst, int ddepth, Mat kernelX, Mat kernelY, Point anchor, double delta, int borderType) |
static void | sepFilter2D (Mat src, Mat dst, int ddepth, Mat kernelX, Mat kernelY, Point anchor, double delta) |
static void | sepFilter2D (Mat src, Mat dst, int ddepth, Mat kernelX, Mat kernelY) |
static void | spatialGradient (Mat src, Mat dx, Mat dy, int ksize, int borderType) |
static void | spatialGradient (Mat src, Mat dx, Mat dy, int ksize) |
static void | spatialGradient (Mat src, Mat dx, Mat dy) |
static void | sqrBoxFilter (Mat _src, Mat _dst, int ddepth, Size ksize, Point anchor, bool normalize, int borderType) |
static void | sqrBoxFilter (Mat _src, Mat _dst, int ddepth, Size ksize, Point anchor, bool normalize) |
static void | sqrBoxFilter (Mat _src, Mat _dst, int ddepth, Size ksize) |
static void | undistort (Mat src, Mat dst, Mat cameraMatrix, Mat distCoeffs, Mat newCameraMatrix) |
static void | undistort (Mat src, Mat dst, Mat cameraMatrix, Mat distCoeffs) |
static void | undistortPointsIter (Mat src, Mat dst, Mat cameraMatrix, Mat distCoeffs, Mat R, Mat P, TermCriteria criteria) |
static void | undistortPoints (Mat src, Mat dst, Mat cameraMatrix, Mat distCoeffs, Mat R, Mat P) |
static void | undistortPoints (Mat src, Mat dst, Mat cameraMatrix, Mat distCoeffs) |
static void | warpAffine (Mat src, Mat dst, Mat M, Size dsize, int flags, int borderMode, Scalar borderValue) |
static void | warpAffine (Mat src, Mat dst, Mat M, Size dsize, int flags) |
static void | warpAffine (Mat src, Mat dst, Mat M, Size dsize) |
static void | warpPerspective (Mat src, Mat dst, Mat M, Size dsize, int flags, int borderMode, Scalar borderValue) |
static void | warpPerspective (Mat src, Mat dst, Mat M, Size dsize, int flags) |
static void | warpPerspective (Mat src, Mat dst, Mat M, Size dsize) |
static void | watershed (Mat image, Mat markers) |
static Size | getTextSize (string text, int fontFace, double fontScale, int thickness, int[] baseLine) |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
|
static |
const int OpenCVForUnity.Imgproc.ADAPTIVE_THRESH_GAUSSIAN_C = 1 |
const int OpenCVForUnity.Imgproc.ADAPTIVE_THRESH_MEAN_C = 0 |
const int OpenCVForUnity.Imgproc.CC_STAT_AREA = 4 |
const int OpenCVForUnity.Imgproc.CC_STAT_HEIGHT = 3 |
const int OpenCVForUnity.Imgproc.CC_STAT_LEFT = 0 |
const int OpenCVForUnity.Imgproc.CC_STAT_MAX = 5 |
const int OpenCVForUnity.Imgproc.CC_STAT_TOP = 1 |
const int OpenCVForUnity.Imgproc.CC_STAT_WIDTH = 2 |
const int OpenCVForUnity.Imgproc.CCL_DEFAULT = -1 |
const int OpenCVForUnity.Imgproc.CCL_GRANA = 1 |
const int OpenCVForUnity.Imgproc.CCL_WU = 0 |
const int OpenCVForUnity.Imgproc.CHAIN_APPROX_NONE = 1 |
const int OpenCVForUnity.Imgproc.CHAIN_APPROX_SIMPLE = 2 |
const int OpenCVForUnity.Imgproc.CHAIN_APPROX_TC89_KCOS = 4 |
const int OpenCVForUnity.Imgproc.CHAIN_APPROX_TC89_L1 = 3 |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2BGR = 46 |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2BGR_EA = 135 |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2BGR_VNG = 62 |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2BGRA = 139 |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2GRAY = 86 |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2RGB = COLOR_BayerRG2BGR |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2RGB_EA = COLOR_BayerRG2BGR_EA |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2RGB_VNG = COLOR_BayerRG2BGR_VNG |
const int OpenCVForUnity.Imgproc.COLOR_BayerBG2RGBA = COLOR_BayerRG2BGRA |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2BGR = 47 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2BGR_EA = 136 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2BGR_VNG = 63 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2BGRA = 140 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2GRAY = 87 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2RGB = COLOR_BayerGR2BGR |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2RGB_EA = COLOR_BayerGR2BGR_EA |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2RGB_VNG = COLOR_BayerGR2BGR_VNG |
const int OpenCVForUnity.Imgproc.COLOR_BayerGB2RGBA = COLOR_BayerGR2BGRA |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2BGR = 49 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2BGR_EA = 138 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2BGR_VNG = 65 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2BGRA = 142 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2GRAY = 89 |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2RGB = COLOR_BayerGB2BGR |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2RGB_EA = COLOR_BayerGB2BGR_EA |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2RGB_VNG = COLOR_BayerGB2BGR_VNG |
const int OpenCVForUnity.Imgproc.COLOR_BayerGR2RGBA = COLOR_BayerGB2BGRA |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2BGR = 48 |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2BGR_EA = 137 |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2BGR_VNG = 64 |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2BGRA = 141 |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2GRAY = 88 |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2RGB = COLOR_BayerBG2BGR |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2RGB_EA = COLOR_BayerBG2BGR_EA |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2RGB_VNG = COLOR_BayerBG2BGR_VNG |
const int OpenCVForUnity.Imgproc.COLOR_BayerRG2RGBA = COLOR_BayerBG2BGRA |
const int OpenCVForUnity.Imgproc.COLOR_BGR2BGR555 = 22 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2BGR565 = 12 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2BGRA = 0 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2GRAY = 6 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2HLS = 52 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2HLS_FULL = 68 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2HSV = 40 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2HSV_FULL = 66 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2Lab = 44 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2Luv = 50 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2RGB = 4 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2RGBA = 2 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2XYZ = 32 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2YCrCb = 36 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2YUV = 82 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2YUV_I420 = 128 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2YUV_IYUV = COLOR_BGR2YUV_I420 |
const int OpenCVForUnity.Imgproc.COLOR_BGR2YUV_YV12 = 132 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5552BGR = 24 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5552BGRA = 28 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5552GRAY = 31 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5552RGB = 25 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5552RGBA = 29 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5652BGR = 14 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5652BGRA = 18 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5652GRAY = 21 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5652RGB = 15 |
const int OpenCVForUnity.Imgproc.COLOR_BGR5652RGBA = 19 |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2BGR = 1 |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2BGR555 = 26 |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2BGR565 = 16 |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2GRAY = 10 |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2RGB = COLOR_RGBA2BGR |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2RGBA = 5 |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2YUV_I420 = 130 |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2YUV_IYUV = COLOR_BGRA2YUV_I420 |
const int OpenCVForUnity.Imgproc.COLOR_BGRA2YUV_YV12 = 134 |
const int OpenCVForUnity.Imgproc.COLOR_COLORCVT_MAX = 143 |
const int OpenCVForUnity.Imgproc.COLOR_GRAY2BGR = 8 |
const int OpenCVForUnity.Imgproc.COLOR_GRAY2BGR555 = 30 |
const int OpenCVForUnity.Imgproc.COLOR_GRAY2BGR565 = 20 |
const int OpenCVForUnity.Imgproc.COLOR_GRAY2BGRA = 9 |
const int OpenCVForUnity.Imgproc.COLOR_GRAY2RGB = COLOR_GRAY2BGR |
const int OpenCVForUnity.Imgproc.COLOR_GRAY2RGBA = COLOR_GRAY2BGRA |
const int OpenCVForUnity.Imgproc.COLOR_HLS2BGR = 60 |
const int OpenCVForUnity.Imgproc.COLOR_HLS2BGR_FULL = 72 |
const int OpenCVForUnity.Imgproc.COLOR_HLS2RGB = 61 |
const int OpenCVForUnity.Imgproc.COLOR_HLS2RGB_FULL = 73 |
const int OpenCVForUnity.Imgproc.COLOR_HSV2BGR = 54 |
const int OpenCVForUnity.Imgproc.COLOR_HSV2BGR_FULL = 70 |
const int OpenCVForUnity.Imgproc.COLOR_HSV2RGB = 55 |
const int OpenCVForUnity.Imgproc.COLOR_HSV2RGB_FULL = 71 |
const int OpenCVForUnity.Imgproc.COLOR_Lab2BGR = 56 |
const int OpenCVForUnity.Imgproc.COLOR_Lab2LBGR = 78 |
const int OpenCVForUnity.Imgproc.COLOR_Lab2LRGB = 79 |
const int OpenCVForUnity.Imgproc.COLOR_Lab2RGB = 57 |
const int OpenCVForUnity.Imgproc.COLOR_LBGR2Lab = 74 |
const int OpenCVForUnity.Imgproc.COLOR_LBGR2Luv = 76 |
const int OpenCVForUnity.Imgproc.COLOR_LRGB2Lab = 75 |
const int OpenCVForUnity.Imgproc.COLOR_LRGB2Luv = 77 |
const int OpenCVForUnity.Imgproc.COLOR_Luv2BGR = 58 |
const int OpenCVForUnity.Imgproc.COLOR_Luv2LBGR = 80 |
const int OpenCVForUnity.Imgproc.COLOR_Luv2LRGB = 81 |
const int OpenCVForUnity.Imgproc.COLOR_Luv2RGB = 59 |
const int OpenCVForUnity.Imgproc.COLOR_mRGBA2RGBA = 126 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2BGR = COLOR_BGR2RGB |
const int OpenCVForUnity.Imgproc.COLOR_RGB2BGR555 = 23 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2BGR565 = 13 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2BGRA = COLOR_BGR2RGBA |
const int OpenCVForUnity.Imgproc.COLOR_RGB2GRAY = 7 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2HLS = 53 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2HLS_FULL = 69 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2HSV = 41 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2HSV_FULL = 67 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2Lab = 45 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2Luv = 51 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2RGBA = COLOR_BGR2BGRA |
const int OpenCVForUnity.Imgproc.COLOR_RGB2XYZ = 33 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2YCrCb = 37 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2YUV = 83 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2YUV_I420 = 127 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2YUV_IYUV = COLOR_RGB2YUV_I420 |
const int OpenCVForUnity.Imgproc.COLOR_RGB2YUV_YV12 = 131 |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2BGR = 3 |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2BGR555 = 27 |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2BGR565 = 17 |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2BGRA = COLOR_BGRA2RGBA |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2GRAY = 11 |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2mRGBA = 125 |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2RGB = COLOR_BGRA2BGR |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2YUV_I420 = 129 |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2YUV_IYUV = COLOR_RGBA2YUV_I420 |
const int OpenCVForUnity.Imgproc.COLOR_RGBA2YUV_YV12 = 133 |
const int OpenCVForUnity.Imgproc.COLOR_XYZ2BGR = 34 |
const int OpenCVForUnity.Imgproc.COLOR_XYZ2RGB = 35 |
const int OpenCVForUnity.Imgproc.COLOR_YCrCb2BGR = 38 |
const int OpenCVForUnity.Imgproc.COLOR_YCrCb2RGB = 39 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR = 84 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_I420 = COLOR_YUV2BGR_IYUV |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_IYUV = 101 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_NV12 = 91 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_NV21 = 93 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_UYNV = COLOR_YUV2BGR_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_UYVY = 108 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_Y422 = COLOR_YUV2BGR_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_YUNV = COLOR_YUV2BGR_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_YUY2 = 116 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_YUYV = COLOR_YUV2BGR_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_YV12 = 99 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGR_YVYU = 118 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_I420 = COLOR_YUV2BGRA_IYUV |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_IYUV = 105 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_NV12 = 95 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_NV21 = 97 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_UYNV = COLOR_YUV2BGRA_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_UYVY = 112 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_Y422 = COLOR_YUV2BGRA_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_YUNV = COLOR_YUV2BGRA_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_YUY2 = 120 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_YUYV = COLOR_YUV2BGRA_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_YV12 = 103 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2BGRA_YVYU = 122 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_420 = 106 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_I420 = COLOR_YUV2GRAY_420 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_IYUV = COLOR_YUV2GRAY_420 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_NV12 = COLOR_YUV2GRAY_420 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_NV21 = COLOR_YUV2GRAY_420 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_UYNV = COLOR_YUV2GRAY_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_UYVY = 123 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_Y422 = COLOR_YUV2GRAY_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_YUNV = COLOR_YUV2GRAY_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_YUY2 = 124 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_YUYV = COLOR_YUV2GRAY_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_YV12 = COLOR_YUV2GRAY_420 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2GRAY_YVYU = COLOR_YUV2GRAY_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB = 85 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_I420 = COLOR_YUV2RGB_IYUV |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_IYUV = 100 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_NV12 = 90 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_NV21 = 92 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_UYNV = COLOR_YUV2RGB_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_UYVY = 107 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_Y422 = COLOR_YUV2RGB_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_YUNV = COLOR_YUV2RGB_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_YUY2 = 115 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_YUYV = COLOR_YUV2RGB_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_YV12 = 98 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGB_YVYU = 117 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_I420 = COLOR_YUV2RGBA_IYUV |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_IYUV = 104 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_NV12 = 94 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_NV21 = 96 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_UYNV = COLOR_YUV2RGBA_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_UYVY = 111 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_Y422 = COLOR_YUV2RGBA_UYVY |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_YUNV = COLOR_YUV2RGBA_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_YUY2 = 119 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_YUYV = COLOR_YUV2RGBA_YUY2 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_YV12 = 102 |
const int OpenCVForUnity.Imgproc.COLOR_YUV2RGBA_YVYU = 121 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420p2BGR = COLOR_YUV2BGR_YV12 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420p2BGRA = COLOR_YUV2BGRA_YV12 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420p2GRAY = COLOR_YUV2GRAY_420 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420p2RGB = COLOR_YUV2RGB_YV12 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420p2RGBA = COLOR_YUV2RGBA_YV12 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420sp2BGR = COLOR_YUV2BGR_NV21 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420sp2BGRA = COLOR_YUV2BGRA_NV21 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420sp2GRAY = COLOR_YUV2GRAY_420 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420sp2RGB = COLOR_YUV2RGB_NV21 |
const int OpenCVForUnity.Imgproc.COLOR_YUV420sp2RGBA = COLOR_YUV2RGBA_NV21 |
const int OpenCVForUnity.Imgproc.COLORMAP_AUTUMN = 0 |
const int OpenCVForUnity.Imgproc.COLORMAP_BONE = 1 |
const int OpenCVForUnity.Imgproc.COLORMAP_COOL = 8 |
const int OpenCVForUnity.Imgproc.COLORMAP_HOT = 11 |
const int OpenCVForUnity.Imgproc.COLORMAP_HSV = 9 |
const int OpenCVForUnity.Imgproc.COLORMAP_JET = 2 |
const int OpenCVForUnity.Imgproc.COLORMAP_OCEAN = 5 |
const int OpenCVForUnity.Imgproc.COLORMAP_PARULA = 12 |
const int OpenCVForUnity.Imgproc.COLORMAP_PINK = 10 |
const int OpenCVForUnity.Imgproc.COLORMAP_RAINBOW = 4 |
const int OpenCVForUnity.Imgproc.COLORMAP_SPRING = 7 |
const int OpenCVForUnity.Imgproc.COLORMAP_SUMMER = 6 |
const int OpenCVForUnity.Imgproc.COLORMAP_WINTER = 3 |
const int OpenCVForUnity.Imgproc.CONTOURS_MATCH_I1 = 1 |
const int OpenCVForUnity.Imgproc.CONTOURS_MATCH_I2 = 2 |
const int OpenCVForUnity.Imgproc.CONTOURS_MATCH_I3 = 3 |
const int OpenCVForUnity.Imgproc.CV_BILATERAL = 4 |
const int OpenCVForUnity.Imgproc.CV_BLUR = 1 |
const int OpenCVForUnity.Imgproc.CV_BLUR_NO_SCALE = 0 |
const int OpenCVForUnity.Imgproc.CV_CANNY_L2_GRADIENT = (1 << 31) |
const int OpenCVForUnity.Imgproc.CV_CHAIN_CODE = 0 |
const int OpenCVForUnity.Imgproc.CV_CLOCKWISE = 1 |
const int OpenCVForUnity.Imgproc.CV_COMP_BHATTACHARYYA = 3 |
const int OpenCVForUnity.Imgproc.CV_COMP_CHISQR = 1 |
const int OpenCVForUnity.Imgproc.CV_COMP_CHISQR_ALT = 4 |
const int OpenCVForUnity.Imgproc.CV_COMP_CORREL = 0 |
const int OpenCVForUnity.Imgproc.CV_COMP_HELLINGER = CV_COMP_BHATTACHARYYA |
const int OpenCVForUnity.Imgproc.CV_COMP_INTERSECT = 2 |
const int OpenCVForUnity.Imgproc.CV_COMP_KL_DIV = 5 |
const int OpenCVForUnity.Imgproc.CV_CONTOURS_MATCH_I1 = 1 |
const int OpenCVForUnity.Imgproc.CV_CONTOURS_MATCH_I2 = 2 |
const int OpenCVForUnity.Imgproc.CV_CONTOURS_MATCH_I3 = 3 |
const int OpenCVForUnity.Imgproc.CV_COUNTER_CLOCKWISE = 2 |
const int OpenCVForUnity.Imgproc.CV_DIST_C = 3 |
const int OpenCVForUnity.Imgproc.CV_DIST_FAIR = 5 |
const int OpenCVForUnity.Imgproc.CV_DIST_HUBER = 7 |
const int OpenCVForUnity.Imgproc.CV_DIST_L1 = 1 |
const int OpenCVForUnity.Imgproc.CV_DIST_L12 = 4 |
const int OpenCVForUnity.Imgproc.CV_DIST_L2 = 2 |
const int OpenCVForUnity.Imgproc.CV_DIST_LABEL_CCOMP = 0 |
const int OpenCVForUnity.Imgproc.CV_DIST_LABEL_PIXEL = 1 |
const int OpenCVForUnity.Imgproc.CV_DIST_MASK_3 = 3 |
const int OpenCVForUnity.Imgproc.CV_DIST_MASK_5 = 5 |
const int OpenCVForUnity.Imgproc.CV_DIST_MASK_PRECISE = 0 |
const int OpenCVForUnity.Imgproc.CV_DIST_USER = -1 |
const int OpenCVForUnity.Imgproc.CV_DIST_WELSCH = 6 |
const int OpenCVForUnity.Imgproc.CV_GAUSSIAN = 2 |
const int OpenCVForUnity.Imgproc.CV_GAUSSIAN_5x5 = 7 |
const int OpenCVForUnity.Imgproc.CV_HOUGH_GRADIENT = 3 |
const int OpenCVForUnity.Imgproc.CV_HOUGH_MULTI_SCALE = 2 |
const int OpenCVForUnity.Imgproc.CV_HOUGH_PROBABILISTIC = 1 |
const int OpenCVForUnity.Imgproc.CV_HOUGH_STANDARD = 0 |
const int OpenCVForUnity.Imgproc.CV_LINK_RUNS = 5 |
const int OpenCVForUnity.Imgproc.CV_MAX_SOBEL_KSIZE = 7 |
const int OpenCVForUnity.Imgproc.CV_MEDIAN = 3 |
const int OpenCVForUnity.Imgproc.CV_mRGBA2RGBA = 126 |
const int OpenCVForUnity.Imgproc.CV_POLY_APPROX_DP = 0 |
const int OpenCVForUnity.Imgproc.CV_RGBA2mRGBA = 125 |
const int OpenCVForUnity.Imgproc.CV_SCHARR = -1 |
const int OpenCVForUnity.Imgproc.CV_SHAPE_CROSS = 1 |
const int OpenCVForUnity.Imgproc.CV_SHAPE_CUSTOM = 100 |
const int OpenCVForUnity.Imgproc.CV_SHAPE_ELLIPSE = 2 |
const int OpenCVForUnity.Imgproc.CV_SHAPE_RECT = 0 |
const int OpenCVForUnity.Imgproc.CV_WARP_FILL_OUTLIERS = 8 |
const int OpenCVForUnity.Imgproc.CV_WARP_INVERSE_MAP = 16 |
const int OpenCVForUnity.Imgproc.DIST_C = 3 |
const int OpenCVForUnity.Imgproc.DIST_FAIR = 5 |
const int OpenCVForUnity.Imgproc.DIST_HUBER = 7 |
const int OpenCVForUnity.Imgproc.DIST_L1 = 1 |
const int OpenCVForUnity.Imgproc.DIST_L12 = 4 |
const int OpenCVForUnity.Imgproc.DIST_L2 = 2 |
const int OpenCVForUnity.Imgproc.DIST_LABEL_CCOMP = 0 |
const int OpenCVForUnity.Imgproc.DIST_LABEL_PIXEL = 1 |
const int OpenCVForUnity.Imgproc.DIST_MASK_3 = 3 |
const int OpenCVForUnity.Imgproc.DIST_MASK_5 = 5 |
const int OpenCVForUnity.Imgproc.DIST_MASK_PRECISE = 0 |
const int OpenCVForUnity.Imgproc.DIST_USER = -1 |
const int OpenCVForUnity.Imgproc.DIST_WELSCH = 6 |
const int OpenCVForUnity.Imgproc.FLOODFILL_FIXED_RANGE = 1 << 16 |
const int OpenCVForUnity.Imgproc.FLOODFILL_MASK_ONLY = 1 << 17 |
const int OpenCVForUnity.Imgproc.GC_BGD = 0 |
const int OpenCVForUnity.Imgproc.GC_EVAL = 2 |
const int OpenCVForUnity.Imgproc.GC_FGD = 1 |
const int OpenCVForUnity.Imgproc.GC_INIT_WITH_MASK = 1 |
const int OpenCVForUnity.Imgproc.GC_INIT_WITH_RECT = 0 |
const int OpenCVForUnity.Imgproc.GC_PR_BGD = 2 |
const int OpenCVForUnity.Imgproc.GC_PR_FGD = 3 |
const int OpenCVForUnity.Imgproc.HISTCMP_BHATTACHARYYA = 3 |
const int OpenCVForUnity.Imgproc.HISTCMP_CHISQR = 1 |
const int OpenCVForUnity.Imgproc.HISTCMP_CHISQR_ALT = 4 |
const int OpenCVForUnity.Imgproc.HISTCMP_CORREL = 0 |
const int OpenCVForUnity.Imgproc.HISTCMP_HELLINGER = HISTCMP_BHATTACHARYYA |
const int OpenCVForUnity.Imgproc.HISTCMP_INTERSECT = 2 |
const int OpenCVForUnity.Imgproc.HISTCMP_KL_DIV = 5 |
const int OpenCVForUnity.Imgproc.HOUGH_GRADIENT = 3 |
const int OpenCVForUnity.Imgproc.HOUGH_MULTI_SCALE = 2 |
const int OpenCVForUnity.Imgproc.HOUGH_PROBABILISTIC = 1 |
const int OpenCVForUnity.Imgproc.HOUGH_STANDARD = 0 |
const int OpenCVForUnity.Imgproc.INTER_AREA = 3 |
const int OpenCVForUnity.Imgproc.INTER_BITS = 5 |
const int OpenCVForUnity.Imgproc.INTER_BITS2 = INTER_BITS * 2 |
const int OpenCVForUnity.Imgproc.INTER_CUBIC = 2 |
const int OpenCVForUnity.Imgproc.INTER_LANCZOS4 = 4 |
const int OpenCVForUnity.Imgproc.INTER_LINEAR = 1 |
const int OpenCVForUnity.Imgproc.INTER_LINEAR_EXACT = 5 |
const int OpenCVForUnity.Imgproc.INTER_MAX = 7 |
const int OpenCVForUnity.Imgproc.INTER_NEAREST = 0 |
const int OpenCVForUnity.Imgproc.INTER_TAB_SIZE = 1 << INTER_BITS |
const int OpenCVForUnity.Imgproc.INTER_TAB_SIZE2 = INTER_TAB_SIZE * INTER_TAB_SIZE |
const int OpenCVForUnity.Imgproc.INTERSECT_FULL = 2 |
const int OpenCVForUnity.Imgproc.INTERSECT_NONE = 0 |
const int OpenCVForUnity.Imgproc.INTERSECT_PARTIAL = 1 |
const int OpenCVForUnity.Imgproc.LINE_4 = 4 |
const int OpenCVForUnity.Imgproc.LINE_8 = 8 |
const int OpenCVForUnity.Imgproc.LINE_AA = 16 |
const int OpenCVForUnity.Imgproc.LSD_REFINE_ADV = 2 |
const int OpenCVForUnity.Imgproc.LSD_REFINE_NONE = 0 |
const int OpenCVForUnity.Imgproc.LSD_REFINE_STD = 1 |
const int OpenCVForUnity.Imgproc.MARKER_CROSS = 0 |
const int OpenCVForUnity.Imgproc.MARKER_DIAMOND = 3 |
const int OpenCVForUnity.Imgproc.MARKER_SQUARE = 4 |
const int OpenCVForUnity.Imgproc.MARKER_STAR = 2 |
const int OpenCVForUnity.Imgproc.MARKER_TILTED_CROSS = 1 |
const int OpenCVForUnity.Imgproc.MARKER_TRIANGLE_DOWN = 6 |
const int OpenCVForUnity.Imgproc.MARKER_TRIANGLE_UP = 5 |
const int OpenCVForUnity.Imgproc.MORPH_BLACKHAT = 6 |
const int OpenCVForUnity.Imgproc.MORPH_CLOSE = 3 |
const int OpenCVForUnity.Imgproc.MORPH_CROSS = 1 |
const int OpenCVForUnity.Imgproc.MORPH_DILATE = 1 |
const int OpenCVForUnity.Imgproc.MORPH_ELLIPSE = 2 |
const int OpenCVForUnity.Imgproc.MORPH_ERODE = 0 |
const int OpenCVForUnity.Imgproc.MORPH_GRADIENT = 4 |
const int OpenCVForUnity.Imgproc.MORPH_HITMISS = 7 |
const int OpenCVForUnity.Imgproc.MORPH_OPEN = 2 |
const int OpenCVForUnity.Imgproc.MORPH_RECT = 0 |
const int OpenCVForUnity.Imgproc.MORPH_TOPHAT = 5 |
const int OpenCVForUnity.Imgproc.PROJ_SPHERICAL_EQRECT = 1 |
const int OpenCVForUnity.Imgproc.PROJ_SPHERICAL_ORTHO = 0 |
const int OpenCVForUnity.Imgproc.RETR_CCOMP = 2 |
const int OpenCVForUnity.Imgproc.RETR_EXTERNAL = 0 |
const int OpenCVForUnity.Imgproc.RETR_FLOODFILL = 4 |
const int OpenCVForUnity.Imgproc.RETR_LIST = 1 |
const int OpenCVForUnity.Imgproc.RETR_TREE = 3 |
const int OpenCVForUnity.Imgproc.THRESH_BINARY = 0 |
const int OpenCVForUnity.Imgproc.THRESH_BINARY_INV = 1 |
const int OpenCVForUnity.Imgproc.THRESH_MASK = 7 |
const int OpenCVForUnity.Imgproc.THRESH_OTSU = 8 |
const int OpenCVForUnity.Imgproc.THRESH_TOZERO = 3 |
const int OpenCVForUnity.Imgproc.THRESH_TOZERO_INV = 4 |
const int OpenCVForUnity.Imgproc.THRESH_TRIANGLE = 16 |
const int OpenCVForUnity.Imgproc.THRESH_TRUNC = 2 |
const int OpenCVForUnity.Imgproc.TM_CCOEFF = 4 |
const int OpenCVForUnity.Imgproc.TM_CCOEFF_NORMED = 5 |
const int OpenCVForUnity.Imgproc.TM_CCORR = 2 |
const int OpenCVForUnity.Imgproc.TM_CCORR_NORMED = 3 |
const int OpenCVForUnity.Imgproc.TM_SQDIFF = 0 |
const int OpenCVForUnity.Imgproc.TM_SQDIFF_NORMED = 1 |
const int OpenCVForUnity.Imgproc.WARP_FILL_OUTLIERS = 8 |
const int OpenCVForUnity.Imgproc.WARP_INVERSE_MAP = 16 |