47 #ifndef __OPENCV_IMGPROC_HPP__
48 #define __OPENCV_IMGPROC_HPP__
89 int width,
int cn) = 0;
116 int dstcount,
int width) = 0;
118 virtual void reset();
142 int dstcount,
int width,
int cn) = 0;
144 virtual void reset();
231 int srcType,
int dstType,
int bufType,
233 int _columnBorderType=-1,
241 int srcType,
int dstType,
int bufType,
248 bool isolated=
false,
int maxBufRows=-1);
250 virtual int proceed(
const uchar* src,
int srcStep,
int srcCount,
253 virtual void apply(
const Mat& src,
Mat& dst,
256 bool isolated=
false);
260 int remainingInputRows()
const;
261 int remainingOutputRows()
const;
277 int bufStep, startY,
startY0, endY, rowCount, dstY;
300 int symmetryType,
double delta=0,
314 int columnBorderType=-1,
321 int columnBorderType=-1,
const Scalar& borderValue=
Scalar());
328 double sigma1,
double sigma2=0,
332 int dx,
int dy,
int ksize,
333 bool normalize=
false,
int ktype=CV_32F );
336 int dx,
int dy,
int ksize,
339 CV_EXPORTS Ptr<BaseRowFilter>
getRowSumFilter(
int srcType,
int sumType,
340 int ksize,
int anchor=-1);
343 int ksize,
int anchor=-1,
353 double gamma,
double psi=CV_PI*0.5,
int ktype=CV_64F );
370 static inline Scalar morphologyDefaultBorderValue() {
return Scalar::all(DBL_MAX); }
375 int columnBorderType=-1,
376 const Scalar& borderValue=morphologyDefaultBorderValue());
395 double sigmaX,
double sigmaY=0,
399 double sigmaColor,
double sigmaSpace,
403 double sigmaSpace,
double maxSigmaColor = 20.0,
Point anchor=
Point(-1, -1),
428 int dx,
int dy,
int ksize=3,
445 int apertureSize=3,
bool L2gradient=
false );
449 int blockSize,
int ksize=3,
458 CV_EXPORTS
void eigen2x2(
const float*
a,
float* e,
int n );
462 int blockSize,
int ksize,
476 int maxCorners,
double qualityLevel,
double minDistance,
478 bool useHarrisDetector=
false,
double k=0.04 );
483 double srn=0,
double stn=0 );
488 double minLineLength=0,
double maxLineGap=0 );
492 int method,
double dp,
double minDist,
524 virtual void setTemplateImpl(
const Mat& edges,
const Mat& dx,
const Mat& dy,
Point templCenter) = 0;
526 virtual void releaseImpl() = 0;
529 Mat edges_, dx_, dy_;
536 const Scalar& borderValue=morphologyDefaultBorderValue() );
542 const Scalar& borderValue=morphologyDefaultBorderValue() );
549 const Scalar& borderValue=morphologyDefaultBorderValue() );
565 Size dsize,
double fx=0,
double fy=0,
598 int dstmap1type,
bool nninterpolation=
false );
657 double thresh,
double maxval,
int type );
664 double maxValue,
int adaptiveMethod,
665 int thresholdType,
int blockSize,
double C );
703 bool centerPrincipalPoint=
false );
713 CV_EXPORTS
void calcHist(
const Mat* images,
int nimages,
719 CV_EXPORTS
void calcHist(
const Mat* images,
int nimages,
722 const int* histSize,
const float**
ranges,
728 const vector<int>& histSize,
729 const vector<float>&
ranges,
736 double scale=1,
bool uniform=
true );
742 double scale=1,
bool uniform=
true );
746 const vector<float>&
ranges,
771 CV_WRAP
virtual void setClipLimit(
double clipLimit) = 0;
772 CV_WRAP
virtual double getClipLimit()
const = 0;
774 CV_WRAP
virtual void setTilesGridSize(
Size tileGridSize) = 0;
775 CV_WRAP
virtual Size getTilesGridSize()
const = 0;
777 CV_WRAP
virtual void collectGarbage() = 0;
790 double sp,
double sr,
int maxLevel=1,
829 int distanceType,
int maskSize );
1100 Moments(
double m00,
double m10,
double m01,
double m20,
double m11,
1101 double m02,
double m30,
double m21,
double m12,
double m03 );
1108 CV_PROP_RW
double m00, m10, m01, m20, m11, m02,
m30, m21, m12, m03;
1110 CV_PROP_RW
double mu20, mu11, mu02,
mu30, mu21, mu12, mu03;
1112 CV_PROP_RW
double nu20, nu11, nu02,
nu30, nu21, nu12, nu03;
1160 int thickness=1,
int lineType=8,
1167 double epsilon,
bool closed );
1182 int method,
double parameter );
1185 bool clockwise=
false,
bool returnPoints=
true );
1212 PTLOC_OUTSIDE_RECT = -1,
1220 NEXT_AROUND_ORG = 0x00,
1221 NEXT_AROUND_DST = 0x22,
1222 PREV_AROUND_ORG = 0x11,
1223 PREV_AROUND_DST = 0x33,
1224 NEXT_AROUND_LEFT = 0x13,
1225 NEXT_AROUND_RIGHT = 0x31,
1226 PREV_AROUND_LEFT = 0x20,
1227 PREV_AROUND_RIGHT = 0x02
1232 CV_WRAP
void initDelaunay(
Rect rect);
1235 CV_WRAP
void insert(
const vector<Point2f>& ptvec);
1239 CV_WRAP
void getEdgeList(CV_OUT vector<Vec4f>& edgeList)
const;
1240 CV_WRAP
void getTriangleList(CV_OUT vector<Vec6f>& triangleList)
const;
1241 CV_WRAP
void getVoronoiFacetList(
const vector<int>&
idx, CV_OUT vector<vector<Point2f> >& facetList,
1242 CV_OUT vector<Point2f>& facetCenters);
1244 CV_WRAP
Point2f getVertex(
int vertex, CV_OUT
int* firstEdge=0)
const;
1246 CV_WRAP
int getEdge(
int edge,
int nextEdgeType )
const;
1247 CV_WRAP
int nextEdge(
int edge)
const;
1248 CV_WRAP
int rotateEdge(
int edge,
int rotate)
const;
1249 CV_WRAP
int symEdge(
int edge)
const;
1250 CV_WRAP
int edgeOrg(
int edge, CV_OUT
Point2f* orgpt=0)
const;
1251 CV_WRAP
int edgeDst(
int edge, CV_OUT
Point2f* dstpt=0)
const;
1255 void deleteEdge(
int edge);
1256 int newPoint(
Point2f pt,
bool isvirtual,
int firstEdge=0);
1257 void deletePoint(
int vtx);
1258 void setEdgePoints(
int edge,
int orgPt,
int dstPt );
1259 void splice(
int edgeA,
int edgeB );
1260 int connectEdges(
int edgeA,
int edgeB );
1261 void swapEdges(
int edge );
1264 void clearVoronoi();
1265 void checkSubdiv()
const;
1270 Vertex(
Point2f pt,
bool _isvirtual,
int _firstEdge=0);
1271 bool isvirtual()
const;
1272 bool isfree()
const;
1280 QuadEdge(
int edgeidx);
1281 bool isfree()
const;
CV_EXPORTS_W void HoughCircles(InputArray image, OutputArray circles, int method, double dp, double minDist, double param1=100, double param2=100, int minRadius=0, int maxRadius=0)
finds circles in the grayscale image using 2+1 gradient Hough transform
int dims
Definition: core_c.h:218
Definition: imgproc.hpp:65
CvArr CvPoint2D32f double M
Definition: imgproc_c.h:186
Point2f bottomRight
Definition: imgproc.hpp:1294
Definition: imgproc.hpp:889
Point anchor
Definition: imgproc.hpp:265
CV_EXPORTS_W double contourArea(InputArray contour, bool oriented=false)
computes the contour area
bool isSeparable() const
returns true if the filter is separable
Definition: imgproc.hpp:258
Definition: imgproc.hpp:878
Definition: imgproc.hpp:926
Point2i Point
Definition: core.hpp:893
const CvMat const CvMat CvSize CvMat CvMat * H2
Definition: calib3d.hpp:297
Definition: imgproc.hpp:286
Definition: imgproc.hpp:1078
OutputArray OutputArray int sdepth
Definition: imgproc.hpp:621
Definition: imgproc.hpp:879
area-based (or super) interpolation
Definition: imgproc.hpp:557
Definition: imgproc.hpp:1032
CvPoint2D32f pt[4]
Definition: imgproc_c.h:410
CV_EXPORTS_W void cornerHarris(InputArray src, OutputArray dst, int blockSize, int ksize, double k, int borderType=BORDER_DEFAULT)
computes Harris cornerness criteria at each image pixel
CV_EXPORTS_W void minEnclosingCircle(InputArray points, CV_OUT Point2f ¢er, CV_OUT float &radius)
computes the minimal enclosing circle for a set of points
Definition: imgproc.hpp:937
CvArr * edges
Definition: imgproc_c.h:555
int recentEdge
Definition: imgproc.hpp:1292
Definition: imgproc.hpp:1145
CV_EXPORTS_W float initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, int projType=PROJ_SPHERICAL_EQRECT, double alpha=0)
initializes maps for cv::remap() for wide-angle
const _OutputArray & OutputArray
Definition: core.hpp:1449
Definition: imgproc.hpp:963
Definition: imgproc.hpp:852
Definition: imgproc.hpp:1056
The Base Class for Column-wise Filters.
Definition: imgproc.hpp:107
Definition: imgproc.hpp:1024
IplImage CvRect * roi
Definition: legacy.hpp:234
GLdouble GLdouble GLdouble GLdouble top
Termination criteria in iterative algorithms.
Definition: core.hpp:2091
Definition: imgproc.hpp:585
Definition: imgproc.hpp:287
Definition: imgproc.hpp:854
bicubic interpolation
Definition: imgproc.hpp:556
retrieve all the contours and the whole hierarchy
Definition: imgproc.hpp:1135
Definition: imgproc.hpp:1123
Definition: imgproc.hpp:379
int borderElemSize
Definition: imgproc.hpp:272
CV_EXPORTS int getKernelType(InputArray kernel, Point anchor)
returns type (one of KERNEL_*) of 1D or 2D kernel specified by its coefficients.
Definition: imgproc.hpp:922
Definition: imgproc.hpp:933
CV_EXPORTS_W void undistortPoints(InputArray src, OutputArray dst, InputArray cameraMatrix, InputArray distCoeffs, InputArray R=noArray(), InputArray P=noArray())
returns points' coordinates after lens distortion correction
CV_EXPORTS_W void adaptiveThreshold(InputArray src, OutputArray dst, double maxValue, int adaptiveMethod, int thresholdType, int blockSize, double C)
applies variable (adaptive) threshold to the image
CV_EXPORTS_W Mat getRotationMatrix2D(Point2f center, double angle, double scale)
returns 2x3 affine transformation matrix for the planar rotation.
Definition: imgproc.hpp:975
Definition: imgproc.hpp:905
Definition: imgproc.hpp:894
vector< uchar > srcRow
Definition: imgproc.hpp:274
CV_EXPORTS_W void cornerSubPix(InputArray image, InputOutputArray corners, Size winSize, Size zeroZone, TermCriteria criteria)
adjusts the corner locations with sub-pixel accuracy to maximize the certain cornerness criteria ...
Definition: imgproc.hpp:1017
Definition: imgproc.hpp:1064
Definition: imgproc.hpp:1019
CV_EXPORTS_W void convertMaps(InputArray map1, InputArray map2, OutputArray dstmap1, OutputArray dstmap2, int dstmap1type, bool nninterpolation=false)
converts maps for remap from floating-point to fixed-point format or backwards
Definition: imgproc.hpp:1014
Definition: imgproc.hpp:915
CV_EXPORTS_W void cvtColor(InputArray src, OutputArray dst, int code, int dstCn=0)
converts image from one color space to another
Definition: imgproc.hpp:807
Lanczos interpolation over 8x8 neighborhood.
Definition: imgproc.hpp:558
Definition: types_c.h:415
CV_EXPORTS_W void invertAffineTransform(InputArray M, OutputArray iM)
computes 2x3 affine transformation matrix that is inverse to the specified 2x3 affine transformation...
Definition: imgproc.hpp:1054
Definition: imgproc.hpp:1079
Definition: imgproc.hpp:1033
Size ksize
Definition: imgproc.hpp:145
Definition: imgproc.hpp:978
Ptr< BaseFilter > filter2D
Definition: imgproc.hpp:280
Definition: imgproc.hpp:650
Point anchor
Definition: imgproc.hpp:146
Definition: imgproc.hpp:692
Definition: types_c.h:338
void delete_obj()
deletes the object. Override if needed
Definition: operations.hpp:2612
Definition: imgproc.hpp:1086
Definition: imgproc.hpp:1065
Definition: imgproc.hpp:941
const CvArr * convexhull
Definition: imgproc_c.h:400
Size2i Size
Definition: core.hpp:896
Definition: imgproc.hpp:992
Definition: types_c.h:405
Definition: imgproc.hpp:808
void int double dp
Definition: imgproc_c.h:608
CV_EXPORTS_W void cornerMinEigenVal(InputArray src, OutputArray dst, int blockSize, int ksize=3, int borderType=BORDER_DEFAULT)
computes minimum eigen value of 2x2 derivative covariation matrix at each pixel - the cornerness crit...
Definition: imgproc.hpp:1043
CV_EXPORTS_W void accumulate(InputArray src, InputOutputArray dst, InputArray mask=noArray())
adds image to the accumulator (dst += src). Unlike cv::add, dst and src can have different types...
Definition: imgproc.hpp:584
Definition: imgproc.hpp:1057
Definition: imgproc.hpp:1123
Definition: imgproc.hpp:864
GLenum GLint GLenum GLsizei GLsizei GLsizei GLint GLsizei const GLvoid * bits
CV_EXPORTS_W void pyrMeanShiftFiltering(InputArray src, OutputArray dst, double sp, double sr, int maxLevel=1, TermCriteria termcrit=TermCriteria(TermCriteria::MAX_ITER+TermCriteria::EPS, 5, 1))
filters image using meanshift algorithm
CvSeq * contour
Definition: core_c.h:1431
Definition: imgproc.hpp:1045
CV_EXPORTS void calcBackProject(const Mat *images, int nimages, const int *channels, InputArray hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)
computes back projection for the set of images
CV_EXPORTS_W void HoughLinesP(InputArray image, OutputArray lines, double rho, double theta, int threshold, double minLineLength=0, double maxLineGap=0)
finds line segments in the black-n-white image using probabilistic Hough transform ...
Definition: types_c.h:361
CV_EXPORTS_W void getDerivKernels(OutputArray kx, OutputArray ky, int dx, int dy, int ksize, bool normalize=false, int ktype=CV_32F)
initializes kernels of the generalized Sobel operator
const int * idx
Definition: core_c.h:323
CV_EXPORTS_W Moments moments(InputArray array, bool binaryImage=false)
computes moments of the rasterized shape or a vector of points
const CvArr * src1
Definition: core_c.h:436
CV_EXPORTS void calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, OutputArray hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)
computes the joint dense histogram for a set of images.
CV_EXPORTS_W void equalizeHist(InputArray src, OutputArray dst)
normalizes the grayscale image brightness and contrast by normalizing its histogram ...
InputArray InputArrayOfArrays
Definition: core.hpp:1448
Definition: imgproc.hpp:869
Definition: imgproc.hpp:962
OutputArray OutputArray sqsum
Definition: imgproc.hpp:620
CvArr * markers
Definition: imgproc_c.h:130
CvArr double threshold1
Definition: imgproc_c.h:555
Definition: imgproc.hpp:660
int rowBorderType
Definition: imgproc.hpp:270
Definition: imgproc.hpp:988
const CvArr * signature2
Definition: imgproc_c.h:287
CV_EXPORTS Mat getAffineTransform(const Point2f src[], const Point2f dst[])
returns 2x3 affine transformation for the corresponding 3 point pairs.
GLuint src
Definition: core_c.h:1650
CV_EXPORTS_W Mat getGaussianKernel(int ksize, double sigma, int ktype=CV_64F)
returns the Gaussian kernel with the specified parameters
Definition: types_c.h:401
Definition: imgproc.hpp:953
Definition: imgproc.hpp:506
void int double rho
Definition: imgproc_c.h:603
CV_EXPORTS_W void createHanningWindow(OutputArray dst, Size winSize, int type)
CV_EXPORTS_W int borderInterpolate(int p, int len, int borderType)
1D interpolation function: returns coordinate of the "donor" pixel for the specified location p...
int int int flags
Definition: highgui_c.h:186
Definition: imgproc.hpp:950
Definition: types_c.h:403
CV_EXPORTS Ptr< BaseFilter > getMorphologyFilter(int op, int type, InputArray kernel, Point anchor=Point(-1,-1))
returns 2D morphological filter
Definition: imgproc.hpp:499
struct CvMoments CvMoments
foreground
Definition: imgproc.hpp:798
Definition: imgproc.hpp:287
CV_EXPORTS_W double PSNR(InputArray src1, InputArray src2)
computes PSNR image/video quality metric
int d
Definition: legacy.hpp:3064
int startY0
Definition: imgproc.hpp:277
Definition: imgproc.hpp:993
Definition: imgproc.hpp:1143
int double double reps
Definition: imgproc_c.h:616
GLfloat angle
Definition: core_c.h:1297
Definition: imgproc.hpp:1123
most probably foreground
Definition: imgproc.hpp:800
CvPoint center
Definition: core_c.h:1290
Definition: imgproc.hpp:940
CV_EXPORTS_W void getRectSubPix(InputArray image, Size patchSize, Point2f center, OutputArray patch, int patchType=-1)
extracts rectangle from the image at sub-pixel location
Definition: imgproc.hpp:920
Definition: imgproc.hpp:1042
Definition: types_c.h:337
Definition: imgproc.hpp:653
int int int int shape
Definition: imgproc_c.h:223
int freeQEdge
Definition: imgproc.hpp:1288
CV_EXPORTS_W void watershed(InputArray image, InputOutputArray markers)
segments the image using watershed algorithm
CvArr const CvMat * kernel
Definition: imgproc_c.h:89
Definition: imgproc.hpp:985
CV_EXPORTS_W void Canny(InputArray image, OutputArray edges, double threshold1, double threshold2, int apertureSize=3, bool L2gradient=false)
applies Canny edge detector and produces the edge map.
int maxWidth
Definition: imgproc.hpp:266
Definition: imgproc.hpp:935
CV_EXPORTS_W void findContours(InputOutputArray image, OutputArrayOfArrays contours, OutputArray hierarchy, int mode, int method, Point offset=Point())
retrieves contours and the hierarchical information from black-n-white image.
Definition: imgproc.hpp:1008
Definition: types_c.h:366
Definition: types_c.h:360
Definition: imgproc.hpp:921
Definition: imgproc.hpp:983
OutputArray sum
Definition: imgproc.hpp:620
Definition: imgproc.hpp:904
Definition: imgproc.hpp:948
Definition: types_c.h:414
Definition: imgproc.hpp:286
vector< uchar * > rows
Definition: imgproc.hpp:278
Definition: imgproc.hpp:806
CV_EXPORTS_W void matchTemplate(InputArray image, InputArray templ, OutputArray result, int method)
computes the proximity map for the raster template and the image where the template is searched for ...
GLenum GLsizei GLenum GLenum const GLvoid * image
Definition: highgui_c.h:230
Definition: imgproc.hpp:982
Definition: types_c.h:593
CV_EXPORTS void buildPyramid(InputArray src, OutputArrayOfArrays dst, int maxlevel, int borderType=BORDER_DEFAULT)
builds the gaussian pyramid using pyrDown() as a basic operation
Definition: imgproc.hpp:1074
CV_EXPORTS_W void warpAffine(InputArray src, OutputArray dst, InputArray M, Size dsize, int flags=INTER_LINEAR, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar())
warps the image using affine transformation
CV_EXPORTS_W void resize(InputArray src, OutputArray dst, Size dsize, double fx=0, double fy=0, int interpolation=INTER_LINEAR)
resizes the image
CV_EXPORTS_W Point2d phaseCorrelateRes(InputArray src1, InputArray src2, InputArray window, CV_OUT double *response=0)
const CvArr CvArr int method
Definition: imgproc_c.h:281
CV_EXPORTS Ptr< BaseRowFilter > getMorphologyRowFilter(int op, int type, int ksize, int anchor=-1)
returns horizontal 1D morphological filter
CV_EXPORTS_W RotatedRect minAreaRect(InputArray points)
computes the minimal rotated rectangle for a set of points
CV_EXPORTS void eigen2x2(const float *a, float *e, int n)
raster image moments
Definition: imgproc.hpp:1094
Definition: imgproc.hpp:947
Definition: imgproc.hpp:1070
Definition: imgproc.hpp:890
Definition: imgproc.hpp:849
Definition: imgproc.hpp:831
CV_EXPORTS_W double pointPolygonTest(InputArray contour, Point2f pt, bool measureDist)
checks if the point is inside the contour. Optionally computes the signed distance from the point to ...
Definition: imgproc.hpp:936
Definition: imgproc.hpp:66
Point2f topLeft
Definition: imgproc.hpp:1293
CvRect rect
Definition: core_c.h:100
Definition: imgproc.hpp:925
CV_EXPORTS_W void initUndistortRectifyMap(InputArray cameraMatrix, InputArray distCoeffs, InputArray R, InputArray newCameraMatrix, Size size, int m1type, OutputArray map1, OutputArray map2)
initializes maps for cv::remap() to correct lens distortion and optionally rectify the image ...
Definition: imgproc.hpp:981
CV_EXPORTS_W void accumulateProduct(InputArray src1, InputArray src2, InputOutputArray dst, InputArray mask=noArray())
adds product of the 2 images to the accumulator (dst += src1*src2).
Definition: imgproc.hpp:866
const CvPoint2D32f vertex[4]
Definition: legacy.hpp:1070
The 2D size class.
Definition: core.hpp:81
Definition: imgproc.hpp:559
int double double double aeps
Definition: imgproc_c.h:616
const CvArr const CvArr CvArr * result
Definition: core_c.h:805
typedef void(CV_CDECL *CvMouseCallback)(int event
The Base Class for 1D or Row-wise Filters.
Definition: imgproc.hpp:80
vector< uchar > constBorderRow
Definition: imgproc.hpp:276
CvPoint2D32f double CvTermCriteria criteria
Definition: calib3d.hpp:65
Definition: imgproc.hpp:997
Definition: imgproc.hpp:1004
CV_EXPORTS Ptr< FilterEngine > createBoxFilter(int srcType, int dstType, Size ksize, Point anchor=Point(-1,-1), bool normalize=true, int borderType=BORDER_DEFAULT)
returns box filter engine
OutputArray OutputArray int int int labelType
Definition: imgproc.hpp:825
retrieve only the most external (top-level) contours
Definition: imgproc.hpp:1132
Definition: imgproc.hpp:918
Definition: imgproc.hpp:965
Definition: imgproc.hpp:881
Definition: imgproc.hpp:927
Definition: imgproc.hpp:1023
Definition: types_c.h:345
Definition: imgproc.hpp:930
Definition: imgproc.hpp:586
retrieve the connected components (that can possibly be nested)
Definition: imgproc.hpp:1134
GLint GLvoid * img
Definition: legacy.hpp:1150
Definition: imgproc.hpp:286
Definition: imgproc.hpp:961
Definition: imgproc.hpp:1052
Definition: imgproc.hpp:1072
double start
Definition: core_c.h:774
Definition: types_c.h:590
Definition: imgproc.hpp:934
Definition: imgproc.hpp:1037
Definition: types_c.h:334
Definition: imgproc.hpp:892
CV_EXPORTS_W void adaptiveBilateralFilter(InputArray src, OutputArray dst, Size ksize, double sigmaSpace, double maxSigmaColor=20.0, Point anchor=Point(-1,-1), int borderType=BORDER_DEFAULT)
smooths the image using adaptive bilateral filter
Definition: imgproc.hpp:651
CV_EXPORTS_W void remap(InputArray src, OutputArray dst, InputArray map1, InputArray map2, int interpolation, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar())
warps the image using the precomputed maps. The maps are stored in either floating-point or integer f...
CV_EXPORTS_W RotatedRect fitEllipse(InputArray points)
fits ellipse to the set of 2D points
Definition: imgproc.hpp:868
Definition: imgproc.hpp:863
Definition: imgproc.hpp:1000
Definition: imgproc.hpp:938
Definition: imgproc.hpp:358
Definition: imgproc.hpp:851
const _InputArray & InputArray
Definition: core.hpp:1447
Definition: imgproc.hpp:917
Definition: imgproc.hpp:1082
Definition: imgproc.hpp:1020
CV_EXPORTS_W void grabCut(InputArray img, InputOutputArray mask, Rect rect, InputOutputArray bgdModel, InputOutputArray fgdModel, int iterCount, int mode=GC_EVAL)
segments the image using GrabCut algorithm
Definition: imgproc.hpp:876
vector< int > borderTab
Definition: imgproc.hpp:271
CvPoint2D32f CvSubdiv2DEdge * edge
Definition: legacy.hpp:2954
Definition: imgproc.hpp:1027
CV_EXPORTS Ptr< FilterEngine > createGaussianFilter(int type, Size ksize, double sigma1, double sigma2=0, int borderType=BORDER_DEFAULT)
returns the Gaussian filter engine
Definition: imgproc.hpp:906
CV_EXPORTS Ptr< BaseColumnFilter > getLinearColumnFilter(int bufType, int dstType, InputArray kernel, int anchor, int symmetryType, double delta=0, int bits=0)
returns the primitive column filter with the specified kernel
Definition: imgproc.hpp:967
Definition: imgproc.hpp:888
the desired accuracy or change in parameters at which the iterative algorithm stops ...
Definition: core.hpp:2098
Definition: imgproc.hpp:970
Definition: imgproc.hpp:907
Definition: imgproc.hpp:897
Definition: imgproc.hpp:1044
CV_EXPORTS_W void preCornerDetect(InputArray src, OutputArray dst, int ksize, int borderType=BORDER_DEFAULT)
computes another complex cornerness criteria at each pixel
Definition: imgproc.hpp:999
GLclampf GLclampf GLclampf alpha
Definition: core_c.h:687
int CvHistogram * hist
Definition: imgproc_c.h:440
Definition: imgproc.hpp:1005
Definition: imgproc.hpp:1081
const CvMat const CvMat const CvMat CvMat CvMat CvMat CvMat CvSize CvMat * R
Definition: calib3d.hpp:270
CV_EXPORTS_W void convexityDefects(InputArray contour, InputArray convexhull, OutputArray convexityDefects)
computes the contour convexity defects
Definition: imgproc.hpp:998
Definition: imgproc.hpp:1030
Definition: imgproc.hpp:1051
Definition: types_c.h:364
CvPoint const int int contours
Definition: core_c.h:1319
Definition: imgproc.hpp:984
Definition: imgproc.hpp:498
OutputArray OutputArray int int maskSize
Definition: imgproc.hpp:823
Definition: imgproc.hpp:63
The Base Class for Non-Separable 2D Filters.
Definition: imgproc.hpp:133
Definition: imgproc.hpp:973
CvSize int int int CvPoint int delta
Definition: core_c.h:1427
Definition: imgproc.hpp:951
CV_EXPORTS_W void bilateralFilter(InputArray src, OutputArray dst, int d, double sigmaColor, double sigmaSpace, int borderType=BORDER_DEFAULT)
smooths the image using bilateral filter
Definition: imgproc.hpp:945
Ptr< BaseColumnFilter > columnFilter
Definition: imgproc.hpp:282
CV_EXPORTS_W void GaussianBlur(InputArray src, OutputArray dst, Size ksize, double sigmaX, double sigmaY=0, int borderType=BORDER_DEFAULT)
smooths the image using Gaussian filter.
Definition: imgproc.hpp:1206
Definition: imgproc.hpp:818
Definition: imgproc.hpp:875
Definition: imgproc.hpp:1063
Definition: types_c.h:370
CV_EXPORTS_W void Laplacian(InputArray src, OutputArray dst, int ddepth, int ksize=1, double scale=1, double delta=0, int borderType=BORDER_DEFAULT)
applies Laplacian operator to the image
Definition: imgproc.hpp:1059
Definition: imgproc.hpp:891
Definition: types_c.h:412
CvArr int CvScalar param1
Definition: core_c.h:649
Definition: imgproc.hpp:358
Definition: types_c.h:596
CV_EXPORTS_W void blur(InputArray src, OutputArray dst, Size ksize, Point anchor=Point(-1,-1), int borderType=BORDER_DEFAULT)
a synonym for normalized box filter
Definition: types_c.h:591
const CvMat CvMat CvMat int k
Definition: legacy.hpp:3052
Definition: imgproc.hpp:819
CV_EXPORTS_W void morphologyEx(InputArray src, OutputArray dst, int op, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())
applies an advanced morphological operation to the image
Definition: imgproc.hpp:900
CV_EXPORTS Ptr< FilterEngine > createMorphologyFilter(int op, int type, InputArray kernel, Point anchor=Point(-1,-1), int rowBorderType=BORDER_CONSTANT, int columnBorderType=-1, const Scalar &borderValue=morphologyDefaultBorderValue())
returns morphological filter engine. Only MORPH_ERODE and MORPH_DILATE are supported.
Definition: imgproc.hpp:902
Definition: imgproc.hpp:379
CV_EXPORTS_W void HoughLines(InputArray image, OutputArray lines, double rho, double theta, int threshold, double srn=0, double stn=0)
finds lines in the black-n-white image using the standard or pyramid Hough transform ...
OutputArray OutputArray OutputArray tilted
Definition: imgproc.hpp:623
CvArr double double sr
Definition: imgproc_c.h:125
int ksize
Definition: imgproc.hpp:90
Definition: imgproc.hpp:1010
Definition: imgproc.hpp:882
Definition: imgproc.hpp:1075
Definition: imgproc.hpp:652
Definition: imgproc.hpp:1066
Definition: imgproc.hpp:1053
CV_EXPORTS_W void dilate(InputArray src, OutputArray dst, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())
dilates the image (applies the local maximum operator)
Definition: imgproc.hpp:956
Definition: imgproc.hpp:1050
CV_EXPORTS_W void boxFilter(InputArray src, OutputArray dst, int ddepth, Size ksize, Point anchor=Point(-1,-1), bool normalize=true, int borderType=BORDER_DEFAULT)
smooths the image using the box filter. Each pixel is processed in O(1) time
const CvArr CvArr * flow
Definition: tracking.hpp:102
Size ksize
Definition: imgproc.hpp:264
Definition: types_c.h:404
Definition: types_c.h:402
CV_EXPORTS_W void pyrDown(InputArray src, OutputArray dst, const Size &dstsize=Size(), int borderType=BORDER_DEFAULT)
smooths and downsamples the image
Definition: imgproc.hpp:1038
Definition: imgproc.hpp:356
Definition: imgproc.hpp:943
CV_EXPORTS_W Mat getStructuringElement(int shape, Size ksize, Point anchor=Point(-1,-1))
returns structuring element of the specified shape and size
void int double double theta
Definition: imgproc_c.h:603
Definition: imgproc.hpp:989
CV_EXPORTS_W Ptr< CLAHE > createCLAHE(double clipLimit=40.0, Size tileGridSize=Size(8, 8))
OutputArray OutputArrayOfArrays
Definition: core.hpp:1450
Definition: imgproc.hpp:357
vector< QuadEdge > qedges
Definition: imgproc.hpp:1287
CV_EXPORTS Ptr< FilterEngine > createDerivFilter(int srcType, int dstType, int dx, int dy, int ksize, int borderType=BORDER_DEFAULT)
returns filter engine for the generalized Sobel operator
Point2f pt
Definition: imgproc.hpp:1275
int type
Definition: imgproc.hpp:1274
Definition: imgproc.hpp:976
const CvArr CvArr double int int int iterations
Definition: tracking.hpp:102
Definition: imgproc.hpp:62
Definition: types_c.h:362
CV_EXPORTS_W double threshold(InputArray src, OutputArray dst, double thresh, double maxval, int type)
applies fixed threshold to the image
Definition: imgproc.hpp:910
CvArr double double threshold2
Definition: imgproc_c.h:555
Definition: imgproc.hpp:357
Ptr< BaseRowFilter > rowFilter
Definition: imgproc.hpp:281
CV_EXPORTS_W void accumulateSquare(InputArray src, InputOutputArray dst, InputArray mask=noArray())
adds squared src image to the accumulator (dst += src*src).
CV_EXPORTS_W double matchShapes(InputArray contour1, InputArray contour2, int method, double parameter)
matches two contours using one of the available algorithms
Definition: imgproc.hpp:928
Definition: imgproc.hpp:64
Definition: imgproc.hpp:1123
Definition: imgproc.hpp:861
Definition: imgproc.hpp:977
The n-dimensional matrix class.
Definition: core.hpp:1688
Definition: imgproc.hpp:952
Definition: imgproc.hpp:1062
GLint GLenum GLsizei GLsizei GLsizei GLint GLsizei imageSize
Definition: legacy.hpp:631
CV_EXPORTS_W void pyrUp(InputArray src, OutputArray dst, const Size &dstsize=Size(), int borderType=BORDER_DEFAULT)
upsamples and smoothes the image
Definition: imgproc.hpp:972
CV_EXPORTS_W void cornerEigenValsAndVecs(InputArray src, OutputArray dst, int blockSize, int ksize, int borderType=BORDER_DEFAULT)
computes both eigenvalues and the eigenvectors of 2x2 derivative covariation matrix at each pixel...
Definition: imgproc.hpp:1083
Definition: imgproc.hpp:1046
OutputArray InputOutputArray
Definition: core.hpp:1451
Definition: imgproc.hpp:858
ditto
Definition: core.hpp:2097
Definition: imgproc.hpp:1142
CvArr CvPoint2D32f double maxRadius
Definition: imgproc_c.h:191
GLsizei const GLfloat * value
Definition: core_c.h:341
CvSize CvPoint2D32f * corners
Definition: calib3d.hpp:215
CV_EXPORTS_W void Scharr(InputArray src, OutputArray dst, int ddepth, int dx, int dy, double scale=1, double delta=0, int borderType=BORDER_DEFAULT)
applies the vertical or horizontal Scharr operator to the image
Definition: imgproc.hpp:660
bilinear interpolation
Definition: imgproc.hpp:555
OutputArray OutputArray labels
Definition: imgproc.hpp:823
Definition: imgproc.hpp:1016
CV_EXPORTS_W void distanceTransform(InputArray src, OutputArray dst, int distanceType, int maskSize)
computes the distance transform map
Definition: imgproc.hpp:893
static Scalar_< double > all(doublev0)
returns a scalar with all elements set to v0
Definition: imgproc.hpp:1018
Window window
Definition: tracking.hpp:154
Definition: imgproc.hpp:931
Definition: imgproc.hpp:957
GLuint GLuint GLsizei GLenum type
Definition: core_c.h:114
Definition: imgproc.hpp:1002
Definition: imgproc.hpp:855
Definition: imgproc.hpp:1009
Definition: imgproc.hpp:901
int srcType
Definition: imgproc.hpp:263
Definition: imgproc.hpp:887
Definition: imgproc.hpp:909
float ** ranges
Definition: imgproc_c.h:435
Definition: imgproc.hpp:867
Definition: imgproc.hpp:946
CV_EXPORTS_W void convexHull(InputArray points, OutputArray hull, bool clockwise=false, bool returnPoints=true)
computes convex hull for a set of 2D points.
Definition: imgproc.hpp:1080
Definition: imgproc.hpp:359
Definition: imgproc.hpp:923
CV_EXPORTS_W void integral(InputArray src, OutputArray sum, int sdepth=-1)
computes the integral image
int int channels
Definition: core_c.h:73
int dx2
Definition: imgproc.hpp:269
int CvArr CvTermCriteria termcrit
Definition: core_c.h:1472
OutputArray OutputArray int distanceType
Definition: imgproc.hpp:823
CV_EXPORTS_W double arcLength(InputArray curve, bool closed)
computes the contour perimeter (closed=true) or a curve length
Definition: imgproc.hpp:860
CV_EXPORTS_AS(sumElems) Scalar sum(InputArray src)
computes sum of array elements
template 2D point class.
Definition: core.hpp:82
Definition: imgproc.hpp:500
CV_EXPORTS_W void accumulateWeighted(InputArray src, InputOutputArray dst, double alpha, InputArray mask=noArray())
updates the running average (dst = dst*(1-alpha) + src*alpha)
CvArr double sp
Definition: imgproc_c.h:125
Definition: imgproc.hpp:62
Definition: imgproc.hpp:66
Definition: imgproc.hpp:991
Definition: imgproc.hpp:968
Definition: imgproc.hpp:1123
Definition: types_c.h:594
CvArr int code
Definition: imgproc_c.h:144
CV_PROP_RW double nu30
Definition: imgproc.hpp:1112
GLboolean GLboolean GLboolean GLboolean a
Definition: legacy.hpp:633
CV_EXPORTS Ptr< BaseFilter > getLinearFilter(int srcType, int dstType, InputArray kernel, Point anchor=Point(-1,-1), double delta=0, int bits=0)
returns 2D filter with the specified kernel
CV_EXPORTS_W Mat getGaborKernel(Size ksize, double sigma, double theta, double lambd, double gamma, double psi=CV_PI *0.5, int ktype=CV_64F)
returns the Gabor kernel with the specified parameters
CV_EXPORTS_W void filter2D(InputArray src, OutputArray dst, int ddepth, InputArray kernel, Point anchor=Point(-1,-1), double delta=0, int borderType=BORDER_DEFAULT)
applies non-separable 2D linear filter to the image
CV_EXPORTS_W void goodFeaturesToTrack(InputArray image, OutputArray corners, int maxCorners, double qualityLevel, double minDistance, InputArray mask=noArray(), int blockSize=3, bool useHarrisDetector=false, double k=0.04)
finds the strong enough corners where the cornerMinEigenVal() or cornerHarris() report the local maxi...
Definition: imgproc.hpp:766
Definition: imgproc.hpp:986
Definition: imgproc.hpp:1047
CV_EXPORTS Ptr< BaseRowFilter > getRowSumFilter(int srcType, int sumType, int ksize, int anchor=-1)
returns horizontal 1D box filter
The Main Class for Image Filtering.
Definition: imgproc.hpp:222
Definition: imgproc.hpp:1001
vector< Vertex > vtx
Definition: imgproc.hpp:1286
CV_EXPORTS_W Point2d phaseCorrelate(InputArray src1, InputArray src2, InputArray window=noArray())
Base class for high-level OpenCV algorithms.
Definition: core.hpp:4390
CV_EXPORTS_W void copyMakeBorder(InputArray src, OutputArray dst, int top, int bottom, int left, int right, int borderType, const Scalar &value=Scalar())
copies 2D array to a larger destination array with extrapolation of the outer part of src using the s...
Definition: imgproc.hpp:1055
Definition: imgproc.hpp:1007
Definition: imgproc.hpp:971
CV_EXPORTS Ptr< FilterEngine > createSeparableLinearFilter(int srcType, int dstType, InputArray rowKernel, InputArray columnKernel, Point anchor=Point(-1,-1), double delta=0, int rowBorderType=BORDER_DEFAULT, int columnBorderType=-1, const Scalar &borderValue=Scalar())
returns the separable linear filter engine
Definition: imgproc.hpp:379
Definition: imgproc.hpp:1011
Definition: imgproc.hpp:896
int ksize
Definition: imgproc.hpp:119
Definition: imgproc.hpp:1048
CV_EXPORTS_W void drawContours(InputOutputArray image, InputArrayOfArrays contours, int contourIdx, const Scalar &color, int thickness=1, int lineType=8, InputArray hierarchy=noArray(), int maxLevel=INT_MAX, Point offset=Point())
draws contours in the image
int firstEdge
Definition: imgproc.hpp:1273
Definition: imgproc.hpp:63
CvArr int CvScalar CvScalar param2
Definition: core_c.h:649
Definition: imgproc.hpp:1123
CV_EXPORTS float EMD(InputArray signature1, InputArray signature2, int distType, InputArray cost=noArray(), float *lowerBound=0, OutputArray flow=noArray())
unsigned char uchar
Definition: types_c.h:170
CV_EXPORTS_W void Sobel(InputArray src, OutputArray dst, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT)
applies generalized Sobel operator to the image
Definition: imgproc.hpp:652
CV_EXPORTS_W void erode(InputArray src, OutputArray dst, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())
erodes the image (applies the local minimum operator)
Definition: imgproc.hpp:880
double const CvArr double double gamma
Definition: core_c.h:523
GLuint dst
Definition: calib3d.hpp:134
CV_EXPORTS_W Mat getDefaultNewCameraMatrix(InputArray cameraMatrix, Size imgsize=Size(), bool centerPrincipalPoint=false)
returns the default new camera matrix (by default it is the same as cameraMatrix unless centerPricipa...
Definition: types_c.h:595
Definition: imgproc.hpp:885
Definition: types_c.h:365
Definition: imgproc.hpp:960
CV_EXPORTS Ptr< BaseColumnFilter > getMorphologyColumnFilter(int op, int type, int ksize, int anchor=-1)
returns vertical 1D morphological filter
Definition: imgproc.hpp:995
Definition: imgproc.hpp:1277
GLsizei const GLfloat * points
CV_EXPORTS_W void warpPerspective(InputArray src, OutputArray dst, InputArray M, Size dsize, int flags=INTER_LINEAR, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar())
warps the image using perspective transformation
Definition: imgproc.hpp:356
const CvArr * templ
Definition: imgproc_c.h:281
Definition: types_c.h:592
Definition: imgproc.hpp:1069
Smart pointer to dynamically allocated objects.
Definition: core.hpp:1268
GLdouble GLdouble GLdouble bottom
CV_PROP_RW double m30
Definition: imgproc.hpp:1108
Definition: imgproc.hpp:1084
CV_EXPORTS_W Rect boundingRect(InputArray points)
computes the bounding rectangle for a contour
CV_EXPORTS int floodFill(InputOutputArray image, Point seedPoint, Scalar newVal, CV_OUT Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)
fills the semi-uniform image region starting from the specified seed point
Definition: imgproc.hpp:1028
const CvArr * cost
Definition: calib3d.hpp:359
Definition: imgproc.hpp:1073
CV_EXPORTS_W void medianBlur(InputArray src, OutputArray dst, int ksize)
smooths the image using median filter.
CV_PROP_RW double mu30
Definition: imgproc.hpp:1110
Definition: types_c.h:363
Definition: imgproc.hpp:691
CV_EXPORTS Ptr< BaseRowFilter > getLinearRowFilter(int srcType, int bufType, InputArray kernel, int anchor, int symmetryType)
returns the primitive row filter with the specified kernel
Definition: imgproc.hpp:996
CvGraphVtx * vtx
Definition: core_c.h:1151
Definition: imgproc.hpp:942
Definition: imgproc.hpp:899
Definition: imgproc.hpp:1077
Definition: imgproc.hpp:871
nearest neighbor interpolation
Definition: imgproc.hpp:554
CV_EXPORTS OutputArray noArray()
int freePoint
Definition: imgproc.hpp:1289
Definition: imgproc.hpp:64
GLenum GLenum GLenum GLenum GLenum scale
bool validGeometry
Definition: imgproc.hpp:1290
most probably background
Definition: imgproc.hpp:799
Definition: imgproc.hpp:560
Definition: imgproc.hpp:584
const CvArr const CvArr * src2
Definition: core_c.h:436
CV_EXPORTS_W float intersectConvexConvex(InputArray _p1, InputArray _p2, OutputArray _p12, bool handleNested=true)
finds intersection of two convex polygons
CV_EXPORTS_W void approxPolyDP(InputArray curve, OutputArray approxCurve, double epsilon, bool closed)
approximates contour or a curve using Douglas-Peucker algorithm
Point_< float > Point2f
Definition: core.hpp:898
GLenum GLint GLuint mask
Definition: tracking.hpp:132
vector< uchar > ringBuf
Definition: imgproc.hpp:273
Definition: types_c.h:336
Definition: imgproc.hpp:1015
Definition: imgproc.hpp:1144
CV_EXPORTS_W bool isContourConvex(InputArray contour)
returns true if the contour is convex. Does not support contours with self-intersection ...
Definition: imgproc.hpp:884
Definition: imgproc.hpp:958
CvPoint int radius
Definition: core_c.h:1290
Definition: imgproc.hpp:990
Definition: imgproc.hpp:1006
const CvMat const CvMat CvSize CvMat * H1
Definition: calib3d.hpp:297
Definition: imgproc.hpp:1013
Size wholeSize
Definition: imgproc.hpp:267
CV_EXPORTS_W void undistort(InputArray src, OutputArray dst, InputArray cameraMatrix, InputArray distCoeffs, InputArray newCameraMatrix=noArray())
corrects lens distortion for the given camera matrix and distortion coefficients
Definition: types_c.h:335
CV_EXPORTS_W double compareHist(InputArray H1, InputArray H2, int method)
compares two histograms stored in dense arrays
Definition: imgproc.hpp:1039
Rect roi
Definition: imgproc.hpp:268
vector< uchar > constBorderValue
Definition: imgproc.hpp:275
CV_EXPORTS_W void fitLine(InputArray points, OutputArray line, int distType, double param, double reps, double aeps)
fits line to the set of 2D points using M-estimator algorithm
GLsizeiptr size
Definition: core_c.h:939
Definition: imgproc.hpp:877
Scalar_< double > Scalar
Definition: core.hpp:968
CV_EXPORTS Mat getPerspectiveTransform(const Point2f src[], const Point2f dst[])
returns 3x3 perspective transformation for the corresponding 4 point pairs.
Definition: imgproc.hpp:955
Proxy datatype for passing Mat's and vector<>'s as input parameters.
Definition: core.hpp:1400
Definition: imgproc.hpp:651
Definition: imgproc.hpp:872
CV_EXPORTS Ptr< FilterEngine > createLinearFilter(int srcType, int dstType, InputArray kernel, Point _anchor=Point(-1,-1), double delta=0, int rowBorderType=BORDER_DEFAULT, int columnBorderType=-1, const Scalar &borderValue=Scalar())
returns the non-separable linear filter engine
CV_EXPORTS void rotate(const GpuMat &src, GpuMat &dst, Size dsize, double angle, double xShift=0, double yShift=0, int interpolation=INTER_LINEAR, Stream &stream=Stream::Null())
CV_EXPORTS void HuMoments(const Moments &moments, double hu[7])
computes 7 Hu invariants from the moments
Definition: imgproc.hpp:650
Definition: imgproc.hpp:912
Definition: imgproc.hpp:1041
Definition: imgproc.hpp:1060
Rect_< int > Rect
Definition: core.hpp:897
Definition: imgproc.hpp:857
CV_EXPORTS Ptr< BaseColumnFilter > getColumnSumFilter(int sumType, int dstType, int ksize, int anchor=-1, double scale=1)
returns vertical 1D box filter
Definition: types_c.h:413
Definition: imgproc.hpp:870
CV_EXPORTS_W void sepFilter2D(InputArray src, OutputArray dst, int ddepth, InputArray kernelX, InputArray kernelY, Point anchor=Point(-1,-1), double delta=0, int borderType=BORDER_DEFAULT)
applies separable 2D linear filter to the image
Definition: imgproc.hpp:873
Definition: imgproc.hpp:1267
const CvArr * next
Definition: tracking.hpp:102
Definition: imgproc.hpp:1029
Definition: imgproc.hpp:1136
Definition: imgproc.hpp:966
Definition: imgproc.hpp:916
retrieve all the contours without any hierarchical information
Definition: imgproc.hpp:1133
Definition: imgproc.hpp:1036
CV_EXPORTS_W void normalize(InputArray src, OutputArray dst, double alpha=1, double beta=0, int norm_type=NORM_L2, int dtype=-1, InputArray mask=noArray())
scales and shifts array elements so that either the specified norm (alpha) or the minimum (alpha) and...
Definition: imgproc.hpp:848
background
Definition: imgproc.hpp:797
Definition: imgproc.hpp:831
CV_EXPORTS void insert(const Mat &plane, Mat &a, int coi)
Definition: imgproc.hpp:913
CV_EXPORTS_W void line(CV_IN_OUT Mat &img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=8, int shift=0)
draws the line segment (pt1, pt2) in the image
GLuint color
Definition: core_c.h:1276