|  | 
| void | cv::accumulate (InputArray src, InputOutputArray dst, InputArray mask=noArray()) | 
|  | Adds an image to the accumulator image.  More... 
 | 
|  | 
| void | cv::accumulateProduct (InputArray src1, InputArray src2, InputOutputArray dst, InputArray mask=noArray()) | 
|  | Adds the per-element product of two input images to the accumulator image.  More... 
 | 
|  | 
| void | cv::accumulateSquare (InputArray src, InputOutputArray dst, InputArray mask=noArray()) | 
|  | Adds the square of a source image to the accumulator image.  More... 
 | 
|  | 
| void | cv::accumulateWeighted (InputArray src, InputOutputArray dst, double alpha, InputArray mask=noArray()) | 
|  | Updates a running average.  More... 
 | 
|  | 
| void | cv::adaptiveThreshold (InputArray src, OutputArray dst, double maxValue, int adaptiveMethod, int thresholdType, int blockSize, double C) | 
|  | Applies an adaptive threshold to an array.  More... 
 | 
|  | 
| void | cv::applyColorMap (InputArray src, OutputArray dst, int colormap) | 
|  | Applies a GNU Octave/MATLAB equivalent colormap on a given image.  More... 
 | 
|  | 
| void | cv::applyColorMap (InputArray src, OutputArray dst, InputArray userColor) | 
|  | Applies a user colormap on a given image.  More... 
 | 
|  | 
| void | cv::approxPolyDP (InputArray curve, OutputArray approxCurve, double epsilon, bool closed) | 
|  | Approximates a polygonal curve(s) with the specified precision.  More... 
 | 
|  | 
| double | cv::arcLength (InputArray curve, bool closed) | 
|  | Calculates a contour perimeter or a curve length.  More... 
 | 
|  | 
| void | cv::arrowedLine (InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int line_type=8, int shift=0, double tipLength=0.1) | 
|  | Draws a arrow segment pointing from the first point to the second one.  More... 
 | 
|  | 
| void | cv::bilateralFilter (InputArray src, OutputArray dst, int d, double sigmaColor, double sigmaSpace, int borderType=BORDER_DEFAULT) | 
|  | Applies the bilateral filter to an image.  More... 
 | 
|  | 
| void | cv::blendLinear (InputArray src1, InputArray src2, InputArray weights1, InputArray weights2, OutputArray dst) | 
|  | 
| void | cv::blur (InputArray src, OutputArray dst, Size ksize, Point anchor=Point(-1,-1), int borderType=BORDER_DEFAULT) | 
|  | Blurs an image using the normalized box filter.  More... 
 | 
|  | 
| Rect | cv::boundingRect (InputArray array) | 
|  | Calculates the up-right bounding rectangle of a point set or non-zero pixels of gray-scale image.  More... 
 | 
|  | 
| void | cv::boxFilter (InputArray src, OutputArray dst, int ddepth, Size ksize, Point anchor=Point(-1,-1), bool normalize=true, int borderType=BORDER_DEFAULT) | 
|  | Blurs an image using the box filter.  More... 
 | 
|  | 
| void | cv::boxPoints (RotatedRect box, OutputArray points) | 
|  | Finds the four vertices of a rotated rect. Useful to draw the rotated rectangle.  More... 
 | 
|  | 
| void | cv::buildPyramid (InputArray src, OutputArrayOfArrays dst, int maxlevel, int borderType=BORDER_DEFAULT) | 
|  | Constructs the Gaussian pyramid for an image.  More... 
 | 
|  | 
| void | cv::calcBackProject (const Mat *images, int nimages, const int *channels, InputArray hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true) | 
|  | Calculates the back projection of a histogram.  More... 
 | 
|  | 
| void | cv::calcBackProject (const Mat *images, int nimages, const int *channels, const SparseMat &hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true) | 
|  | 
| void | cv::calcBackProject (InputArrayOfArrays images, const std::vector< int > &channels, InputArray hist, OutputArray dst, const std::vector< float > &ranges, double scale) | 
|  | 
| void | cv::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) | 
|  | Calculates a histogram of a set of arrays.  More... 
 | 
|  | 
| void | cv::calcHist (const Mat *images, int nimages, const int *channels, InputArray mask, SparseMat &hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false) | 
|  | 
| void | cv::calcHist (InputArrayOfArrays images, const std::vector< int > &channels, InputArray mask, OutputArray hist, const std::vector< int > &histSize, const std::vector< float > &ranges, bool accumulate=false) | 
|  | 
| void | cv::Canny (InputArray image, OutputArray edges, double threshold1, double threshold2, int apertureSize=3, bool L2gradient=false) | 
|  | Finds edges in an image using the Canny algorithm [39] .  More... 
 | 
|  | 
| void | cv::Canny (InputArray dx, InputArray dy, OutputArray edges, double threshold1, double threshold2, bool L2gradient=false) | 
|  | 
| void | cv::circle (InputOutputArray img, Point center, int radius, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0) | 
|  | Draws a circle.  More... 
 | 
|  | 
| bool | cv::clipLine (Size imgSize, Point &pt1, Point &pt2) | 
|  | Clips the line against the image rectangle.  More... 
 | 
|  | 
| bool | cv::clipLine (Size2l imgSize, Point2l &pt1, Point2l &pt2) | 
|  | 
| bool | cv::clipLine (Rect imgRect, Point &pt1, Point &pt2) | 
|  | 
| double | cv::compareHist (InputArray H1, InputArray H2, int method) | 
|  | Compares two histograms.  More... 
 | 
|  | 
| double | cv::compareHist (const SparseMat &H1, const SparseMat &H2, int method) | 
|  | 
| int | cv::connectedComponents (InputArray image, OutputArray labels, int connectivity, int ltype, int ccltype) | 
|  | computes the connected components labeled image of boolean image  More... 
 | 
|  | 
| int | cv::connectedComponents (InputArray image, OutputArray labels, int connectivity=8, int ltype=CV_32S) | 
|  | 
| int | cv::connectedComponentsWithStats (InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity, int ltype, int ccltype) | 
|  | computes the connected components labeled image of boolean image and also produces a statistics output for each label  More... 
 | 
|  | 
| int | cv::connectedComponentsWithStats (InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity=8, int ltype=CV_32S) | 
|  | 
| double | cv::contourArea (InputArray contour, bool oriented=false) | 
|  | Calculates a contour area.  More... 
 | 
|  | 
| void | cv::convertMaps (InputArray map1, InputArray map2, OutputArray dstmap1, OutputArray dstmap2, int dstmap1type, bool nninterpolation=false) | 
|  | Converts image transformation maps from one representation to another.  More... 
 | 
|  | 
| void | cv::convexHull (InputArray points, OutputArray hull, bool clockwise=false, bool returnPoints=true) | 
|  | Finds the convex hull of a point set.  More... 
 | 
|  | 
| void | cv::convexityDefects (InputArray contour, InputArray convexhull, OutputArray convexityDefects) | 
|  | Finds the convexity defects of a contour.  More... 
 | 
|  | 
| void | cv::cornerEigenValsAndVecs (InputArray src, OutputArray dst, int blockSize, int ksize, int borderType=BORDER_DEFAULT) | 
|  | Calculates eigenvalues and eigenvectors of image blocks for corner detection.  More... 
 | 
|  | 
| void | cv::cornerHarris (InputArray src, OutputArray dst, int blockSize, int ksize, double k, int borderType=BORDER_DEFAULT) | 
|  | Harris corner detector.  More... 
 | 
|  | 
| void | cv::cornerMinEigenVal (InputArray src, OutputArray dst, int blockSize, int ksize=3, int borderType=BORDER_DEFAULT) | 
|  | Calculates the minimal eigenvalue of gradient matrices for corner detection.  More... 
 | 
|  | 
| void | cv::cornerSubPix (InputArray image, InputOutputArray corners, Size winSize, Size zeroZone, TermCriteria criteria) | 
|  | Refines the corner locations.  More... 
 | 
|  | 
| Ptr< CLAHE > | cv::createCLAHE (double clipLimit=40.0, Size tileGridSize=Size(8, 8)) | 
|  | Creates a smart pointer to a cv::CLAHE class and initializes it.  More... 
 | 
|  | 
| Ptr< GeneralizedHoughBallard > | cv::createGeneralizedHoughBallard () | 
|  | Creates a smart pointer to a cv::GeneralizedHoughBallard class and initializes it.  More... 
 | 
|  | 
| Ptr< GeneralizedHoughGuil > | cv::createGeneralizedHoughGuil () | 
|  | Creates a smart pointer to a cv::GeneralizedHoughGuil class and initializes it.  More... 
 | 
|  | 
| void | cv::createHanningWindow (OutputArray dst, Size winSize, int type) | 
|  | This function computes a Hanning window coefficients in two dimensions.  More... 
 | 
|  | 
| Ptr< LineSegmentDetector > | cv::createLineSegmentDetector (int refine=LSD_REFINE_STD, double scale=0.8, double sigma_scale=0.6, double quant=2.0, double ang_th=22.5, double log_eps=0, double density_th=0.7, int n_bins=1024) | 
|  | Creates a smart pointer to a LineSegmentDetector object and initializes it.  More... 
 | 
|  | 
| void | cv::cvtColor (InputArray src, OutputArray dst, int code, int dstCn=0) | 
|  | Converts an image from one color space to another.  More... 
 | 
|  | 
| void | cv::cvtColorTwoPlane (InputArray src1, InputArray src2, OutputArray dst, int code) | 
|  | Converts an image from one color space to another where the source image is stored in two planes.  More... 
 | 
|  | 
| void | cv::demosaicing (InputArray src, OutputArray dst, int code, int dstCn=0) | 
|  | main function for all demosaicing processes  More... 
 | 
|  | 
| void | cv::dilate (InputArray src, OutputArray dst, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue()) | 
|  | Dilates an image by using a specific structuring element.  More... 
 | 
|  | 
| void | cv::distanceTransform (InputArray src, OutputArray dst, OutputArray labels, int distanceType, int maskSize, int labelType=DIST_LABEL_CCOMP) | 
|  | Calculates the distance to the closest zero pixel for each pixel of the source image.  More... 
 | 
|  | 
| void | cv::distanceTransform (InputArray src, OutputArray dst, int distanceType, int maskSize, int dstType=CV_32F) | 
|  | 
| void | cv::divSpectrums (InputArray a, InputArray b, OutputArray c, int flags, bool conjB=false) | 
|  | Performs the per-element division of the first Fourier spectrum by the second Fourier spectrum.  More... 
 | 
|  | 
| void | cv::drawContours (InputOutputArray image, InputArrayOfArrays contours, int contourIdx, const Scalar &color, int thickness=1, int lineType=LINE_8, InputArray hierarchy=noArray(), int maxLevel=INT_MAX, Point offset=Point()) | 
|  | Draws contours outlines or filled contours.  More... 
 | 
|  | 
| void | cv::drawMarker (Mat &img, Point position, const Scalar &color, int markerType=MARKER_CROSS, int markerSize=20, int thickness=1, int line_type=8) | 
|  | Draws a marker on a predefined position in an image.  More... 
 | 
|  | 
| void | cv::ellipse (InputOutputArray img, Point center, Size axes, double angle, double startAngle, double endAngle, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0) | 
|  | Draws a simple or thick elliptic arc or fills an ellipse sector.  More... 
 | 
|  | 
| void | cv::ellipse (InputOutputArray img, const RotatedRect &box, const Scalar &color, int thickness=1, int lineType=LINE_8) | 
|  | 
| void | cv::ellipse2Poly (Point center, Size axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point > &pts) | 
|  | Approximates an elliptic arc with a polyline.  More... 
 | 
|  | 
| void | cv::ellipse2Poly (Point2d center, Size2d axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point2d > &pts) | 
|  | 
| float | cv::EMD (InputArray signature1, InputArray signature2, int distType, InputArray cost=noArray(), float *lowerBound=0, OutputArray flow=noArray()) | 
|  | Computes the "minimal work" distance between two weighted point configurations.  More... 
 | 
|  | 
| void | cv::equalizeHist (InputArray src, OutputArray dst) | 
|  | Equalizes the histogram of a grayscale image.  More... 
 | 
|  | 
| void | cv::erode (InputArray src, OutputArray dst, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue()) | 
|  | Erodes an image by using a specific structuring element.  More... 
 | 
|  | 
| void | cv::fillConvexPoly (Mat &img, const Point *pts, int npts, const Scalar &color, int lineType=LINE_8, int shift=0) | 
|  | 
| void | cv::fillConvexPoly (InputOutputArray img, InputArray points, const Scalar &color, int lineType=LINE_8, int shift=0) | 
|  | Fills a convex polygon.  More... 
 | 
|  | 
| void | cv::fillPoly (Mat &img, const Point **pts, const int *npts, int ncontours, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point()) | 
|  | 
| void | cv::fillPoly (InputOutputArray img, InputArrayOfArrays pts, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point()) | 
|  | Fills the area bounded by one or more polygons.  More... 
 | 
|  | 
| void | cv::filter2D (InputArray src, OutputArray dst, int ddepth, InputArray kernel, Point anchor=Point(-1,-1), double delta=0, int borderType=BORDER_DEFAULT) | 
|  | Convolves an image with the kernel.  More... 
 | 
|  | 
| void | cv::findContours (InputOutputArray image, OutputArrayOfArrays contours, OutputArray hierarchy, int mode, int method, Point offset=Point()) | 
|  | Finds contours in a binary image.  More... 
 | 
|  | 
| void | cv::findContours (InputOutputArray image, OutputArrayOfArrays contours, int mode, int method, Point offset=Point()) | 
|  | 
| RotatedRect | cv::fitEllipse (InputArray points) | 
|  | Fits an ellipse around a set of 2D points.  More... 
 | 
|  | 
| RotatedRect | cv::fitEllipseAMS (InputArray points) | 
|  | Fits an ellipse around a set of 2D points.  More... 
 | 
|  | 
| RotatedRect | cv::fitEllipseDirect (InputArray points) | 
|  | Fits an ellipse around a set of 2D points.  More... 
 | 
|  | 
| void | cv::fitLine (InputArray points, OutputArray line, int distType, double param, double reps, double aeps) | 
|  | Fits a line to a 2D or 3D point set.  More... 
 | 
|  | 
| int | cv::floodFill (InputOutputArray image, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4) | 
|  | 
| int | cv::floodFill (InputOutputArray image, InputOutputArray mask, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4) | 
|  | Fills a connected component with the given color.  More... 
 | 
|  | 
| void | cv::GaussianBlur (InputArray src, OutputArray dst, Size ksize, double sigmaX, double sigmaY=0, int borderType=BORDER_DEFAULT) | 
|  | Blurs an image using a Gaussian filter.  More... 
 | 
|  | 
| Mat | cv::getAffineTransform (const Point2f src[], const Point2f dst[]) | 
|  | Calculates an affine transform from three pairs of the corresponding points.  More... 
 | 
|  | 
| Mat | cv::getAffineTransform (InputArray src, InputArray dst) | 
|  | 
| Mat | cv::getDefaultNewCameraMatrix (InputArray cameraMatrix, Size imgsize=Size(), bool centerPrincipalPoint=false) | 
|  | Returns the default new camera matrix.  More... 
 | 
|  | 
| void | cv::getDerivKernels (OutputArray kx, OutputArray ky, int dx, int dy, int ksize, bool normalize=false, int ktype=CV_32F) | 
|  | Returns filter coefficients for computing spatial image derivatives.  More... 
 | 
|  | 
| double | cv::getFontScaleFromHeight (const int fontFace, const int pixelHeight, const int thickness=1) | 
|  | Calculates the font-specific size to use to achieve a given height in pixels.  More... 
 | 
|  | 
| Mat | cv::getGaborKernel (Size ksize, double sigma, double theta, double lambd, double gamma, double psi=CV_PI *0.5, int ktype=CV_64F) | 
|  | Returns Gabor filter coefficients.  More... 
 | 
|  | 
| Mat | cv::getGaussianKernel (int ksize, double sigma, int ktype=CV_64F) | 
|  | Returns Gaussian filter coefficients.  More... 
 | 
|  | 
| Mat | cv::getPerspectiveTransform (const Point2f src[], const Point2f dst[]) | 
|  | returns 3x3 perspective transformation for the corresponding 4 point pairs.  More... 
 | 
|  | 
| Mat | cv::getPerspectiveTransform (InputArray src, InputArray dst) | 
|  | Calculates a perspective transform from four pairs of the corresponding points.  More... 
 | 
|  | 
| void | cv::getRectSubPix (InputArray image, Size patchSize, Point2f center, OutputArray patch, int patchType=-1) | 
|  | Retrieves a pixel rectangle from an image with sub-pixel accuracy.  More... 
 | 
|  | 
| Mat | cv::getRotationMatrix2D (Point2f center, double angle, double scale) | 
|  | Calculates an affine matrix of 2D rotation.  More... 
 | 
|  | 
| Mat | cv::getStructuringElement (int shape, Size ksize, Point anchor=Point(-1,-1)) | 
|  | Returns a structuring element of the specified size and shape for morphological operations.  More... 
 | 
|  | 
| Size | cv::getTextSize (const String &text, int fontFace, double fontScale, int thickness, int *baseLine) | 
|  | Calculates the width and height of a text string.  More... 
 | 
|  | 
| void | cv::goodFeaturesToTrack (InputArray image, OutputArray corners, int maxCorners, double qualityLevel, double minDistance, InputArray mask=noArray(), int blockSize=3, bool useHarrisDetector=false, double k=0.04) | 
|  | Determines strong corners on an image.  More... 
 | 
|  | 
| void | cv::goodFeaturesToTrack (InputArray image, OutputArray corners, int maxCorners, double qualityLevel, double minDistance, InputArray mask, int blockSize, int gradientSize, bool useHarrisDetector=false, double k=0.04) | 
|  | 
| void | cv::grabCut (InputArray img, InputOutputArray mask, Rect rect, InputOutputArray bgdModel, InputOutputArray fgdModel, int iterCount, int mode=GC_EVAL) | 
|  | Runs the GrabCut algorithm.  More... 
 | 
|  | 
| void | cv::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 a grayscale image using the Hough transform.  More... 
 | 
|  | 
| void | cv::HoughLines (InputArray image, OutputArray lines, double rho, double theta, int threshold, double srn=0, double stn=0, double min_theta=0, double max_theta=CV_PI) | 
|  | Finds lines in a binary image using the standard Hough transform.  More... 
 | 
|  | 
| void | cv::HoughLinesP (InputArray image, OutputArray lines, double rho, double theta, int threshold, double minLineLength=0, double maxLineGap=0) | 
|  | Finds line segments in a binary image using the probabilistic Hough transform.  More... 
 | 
|  | 
| void | cv::HoughLinesPointSet (InputArray point, OutputArray lines, int lines_max, int threshold, double min_rho, double max_rho, double rho_step, double min_theta, double max_theta, double theta_step) | 
|  | Finds lines in a set of points using the standard Hough transform.  More... 
 | 
|  | 
| void | cv::HuMoments (const Moments &moments, double hu[7]) | 
|  | Calculates seven Hu invariants.  More... 
 | 
|  | 
| void | cv::HuMoments (const Moments &m, OutputArray hu) | 
|  | 
| void | cv::initUndistortRectifyMap (InputArray cameraMatrix, InputArray distCoeffs, InputArray R, InputArray newCameraMatrix, Size size, int m1type, OutputArray map1, OutputArray map2) | 
|  | Computes the undistortion and rectification transformation map.  More... 
 | 
|  | 
| float | cv::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 remap for wide-angle  More... 
 | 
|  | 
| void | cv::integral (InputArray src, OutputArray sum, int sdepth=-1) | 
|  | 
| void | cv::integral (InputArray src, OutputArray sum, OutputArray sqsum, int sdepth=-1, int sqdepth=-1) | 
|  | 
| void | cv::integral (InputArray src, OutputArray sum, OutputArray sqsum, OutputArray tilted, int sdepth=-1, int sqdepth=-1) | 
|  | Calculates the integral of an image.  More... 
 | 
|  | 
| float | cv::intersectConvexConvex (InputArray p1, InputArray p2, OutputArray p12, bool handleNested=true) | 
|  | Finds intersection of two convex polygons.  More... 
 | 
|  | 
| void | cv::invertAffineTransform (InputArray M, OutputArray iM) | 
|  | Inverts an affine transformation.  More... 
 | 
|  | 
| bool | cv::isContourConvex (InputArray contour) | 
|  | Tests a contour convexity.  More... 
 | 
|  | 
| void | cv::Laplacian (InputArray src, OutputArray dst, int ddepth, int ksize=1, double scale=1, double delta=0, int borderType=BORDER_DEFAULT) | 
|  | Calculates the Laplacian of an image.  More... 
 | 
|  | 
| void | cv::line (InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0) | 
|  | Draws a line segment connecting two points.  More... 
 | 
|  | 
| void | cv::linearPolar (InputArray src, OutputArray dst, Point2f center, double maxRadius, int flags) | 
|  | Remaps an image to polar coordinates space.  More... 
 | 
|  | 
| void | cv::logPolar (InputArray src, OutputArray dst, Point2f center, double M, int flags) | 
|  | Remaps an image to semilog-polar coordinates space.  More... 
 | 
|  | 
| double | cv::matchShapes (InputArray contour1, InputArray contour2, int method, double parameter) | 
|  | Compares two shapes.  More... 
 | 
|  | 
| void | cv::matchTemplate (InputArray image, InputArray templ, OutputArray result, int method, InputArray mask=noArray()) | 
|  | Compares a template against overlapped image regions.  More... 
 | 
|  | 
| void | cv::medianBlur (InputArray src, OutputArray dst, int ksize) | 
|  | Blurs an image using the median filter.  More... 
 | 
|  | 
| RotatedRect | cv::minAreaRect (InputArray points) | 
|  | Finds a rotated rectangle of the minimum area enclosing the input 2D point set.  More... 
 | 
|  | 
| void | cv::minEnclosingCircle (InputArray points, Point2f ¢er, float &radius) | 
|  | Finds a circle of the minimum area enclosing a 2D point set.  More... 
 | 
|  | 
| double | cv::minEnclosingTriangle (InputArray points, OutputArray triangle) | 
|  | Finds a triangle of minimum area enclosing a 2D point set and returns its area.  More... 
 | 
|  | 
| Moments | cv::moments (InputArray array, bool binaryImage=false) | 
|  | Calculates all of the moments up to the third order of a polygon or rasterized shape.  More... 
 | 
|  | 
| static Scalar | cv::morphologyDefaultBorderValue () | 
|  | returns "magic" border value for erosion and dilation. It is automatically transformed to Scalar::all(-DBL_MAX) for dilation.  More... 
 | 
|  | 
| void | cv::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()) | 
|  | Performs advanced morphological transformations.  More... 
 | 
|  | 
| Point2d | cv::phaseCorrelate (InputArray src1, InputArray src2, InputArray window=noArray(), double *response=0) | 
|  | The function is used to detect translational shifts that occur between two images.  More... 
 | 
|  | 
| double | cv::pointPolygonTest (InputArray contour, Point2f pt, bool measureDist) | 
|  | Performs a point-in-contour test.  More... 
 | 
|  | 
| void | cv::polylines (Mat &img, const Point *const *pts, const int *npts, int ncontours, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0) | 
|  | 
| void | cv::polylines (InputOutputArray img, InputArrayOfArrays pts, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0) | 
|  | Draws several polygonal curves.  More... 
 | 
|  | 
| void | cv::preCornerDetect (InputArray src, OutputArray dst, int ksize, int borderType=BORDER_DEFAULT) | 
|  | Calculates a feature map for corner detection.  More... 
 | 
|  | 
| void | cv::putText (InputOutputArray img, const String &text, Point org, int fontFace, double fontScale, Scalar color, int thickness=1, int lineType=LINE_8, bool bottomLeftOrigin=false) | 
|  | Draws a text string.  More... 
 | 
|  | 
| void | cv::pyrDown (InputArray src, OutputArray dst, const Size &dstsize=Size(), int borderType=BORDER_DEFAULT) | 
|  | Blurs an image and downsamples it.  More... 
 | 
|  | 
| void | cv::pyrMeanShiftFiltering (InputArray src, OutputArray dst, double sp, double sr, int maxLevel=1, TermCriteria termcrit=TermCriteria(TermCriteria::MAX_ITER+TermCriteria::EPS, 5, 1)) | 
|  | Performs initial step of meanshift segmentation of an image.  More... 
 | 
|  | 
| void | cv::pyrUp (InputArray src, OutputArray dst, const Size &dstsize=Size(), int borderType=BORDER_DEFAULT) | 
|  | Upsamples an image and then blurs it.  More... 
 | 
|  | 
| void | cv::rectangle (InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0) | 
|  | Draws a simple, thick, or filled up-right rectangle.  More... 
 | 
|  | 
| void | cv::rectangle (Mat &img, Rect rec, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0) | 
|  | 
| void | cv::remap (InputArray src, OutputArray dst, InputArray map1, InputArray map2, int interpolation, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar()) | 
|  | Applies a generic geometrical transformation to an image.  More... 
 | 
|  | 
| void | cv::resize (InputArray src, OutputArray dst, Size dsize, double fx=0, double fy=0, int interpolation=INTER_LINEAR) | 
|  | Resizes an image.  More... 
 | 
|  | 
| int | cv::rotatedRectangleIntersection (const RotatedRect &rect1, const RotatedRect &rect2, OutputArray intersectingRegion) | 
|  | Finds out if there is any intersection between two rotated rectangles.  More... 
 | 
|  | 
| void | cv::Scharr (InputArray src, OutputArray dst, int ddepth, int dx, int dy, double scale=1, double delta=0, int borderType=BORDER_DEFAULT) | 
|  | Calculates the first x- or y- image derivative using Scharr operator.  More... 
 | 
|  | 
| void | cv::sepFilter2D (InputArray src, OutputArray dst, int ddepth, InputArray kernelX, InputArray kernelY, Point anchor=Point(-1,-1), double delta=0, int borderType=BORDER_DEFAULT) | 
|  | Applies a separable linear filter to an image.  More... 
 | 
|  | 
| void | cv::Sobel (InputArray src, OutputArray dst, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT) | 
|  | Calculates the first, second, third, or mixed image derivatives using an extended Sobel operator.  More... 
 | 
|  | 
| void | cv::spatialGradient (InputArray src, OutputArray dx, OutputArray dy, int ksize=3, int borderType=BORDER_DEFAULT) | 
|  | Calculates the first order image derivative in both x and y using a Sobel operator.  More... 
 | 
|  | 
| void | cv::sqrBoxFilter (InputArray src, OutputArray dst, int ddepth, Size ksize, Point anchor=Point(-1, -1), bool normalize=true, int borderType=BORDER_DEFAULT) | 
|  | Calculates the normalized sum of squares of the pixel values overlapping the filter.  More... 
 | 
|  | 
| double | cv::threshold (InputArray src, OutputArray dst, double thresh, double maxval, int type) | 
|  | Applies a fixed-level threshold to each array element.  More... 
 | 
|  | 
| void | cv::undistort (InputArray src, OutputArray dst, InputArray cameraMatrix, InputArray distCoeffs, InputArray newCameraMatrix=noArray()) | 
|  | Transforms an image to compensate for lens distortion.  More... 
 | 
|  | 
| void | cv::undistortPoints (InputArray src, OutputArray dst, InputArray cameraMatrix, InputArray distCoeffs, InputArray R=noArray(), InputArray P=noArray()) | 
|  | Computes the ideal point coordinates from the observed point coordinates.  More... 
 | 
|  | 
| void | cv::undistortPoints (InputArray src, OutputArray dst, InputArray cameraMatrix, InputArray distCoeffs, InputArray R, InputArray P, TermCriteria criteria) | 
|  | 
| void | cv::warpAffine (InputArray src, OutputArray dst, InputArray M, Size dsize, int flags=INTER_LINEAR, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar()) | 
|  | Applies an affine transformation to an image.  More... 
 | 
|  | 
| void | cv::warpPerspective (InputArray src, OutputArray dst, InputArray M, Size dsize, int flags=INTER_LINEAR, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar()) | 
|  | Applies a perspective transformation to an image.  More... 
 | 
|  | 
| void | cv::warpPolar (InputArray src, OutputArray dst, Size dsize, Point2f center, double maxRadius, int flags) | 
|  | Remaps an image to polar or semilog-polar coordinates space.  More... 
 | 
|  | 
| void | cv::watershed (InputArray image, InputOutputArray markers) | 
|  | Performs a marker-based image segmentation using the watershed algorithm.  More... 
 | 
|  | 
| float | cv::wrapperEMD (InputArray signature1, InputArray signature2, int distType, InputArray cost=noArray(), Ptr< float > lowerBound=Ptr< float >(), OutputArray flow=noArray()) | 
|  |