matgeom

Geometry toolbox for 2D/3D geometric computing

Select category:

geom3d

anglePoints3d
ANGLEPOINTS3D Compute angle between three 3D points.
angles3d
ANGLES3D Conventions for manipulating angles in 3D.
angleSort3d
ANGLESORT3D Sort 3D coplanar points according to their angles in plane.
boundingBox3d
BOUNDINGBOX3D Bounding box of a set of 3D points.
box3dVolume
BOX3DVOLUME Volume of a 3-dimensional box.
boxes3d
BOXES3D Description of functions operating on 3D boxes.
cart2cyl
CART2CYL Convert cartesian to cylindrical coordinates.
cart2sph2d
CART2SPH2D Convert cartesian coordinates to spherical coordinates in degrees.
cart2sph2
CART2SPH2 Convert cartesian coordinates to spherical coordinates.
circle3dOrigin
CIRCLE3DORIGIN Return the first point of a 3D circle.
circle3dPoint
CIRCLE3DPOINT Coordinates of a point on a 3D circle from its position.
circle3dPosition
CIRCLE3DPOSITION Return the angular position of a point on a 3D circle.
circles3d
Description of functions operating on 3D circles.
clipConvexPolygon3dHP
CLIPCONVEXPOLYGON3DHP Clip a convex 3D polygon with Half-space.
clipEdge3d
CLIPEDGE3D Clip a 3D edge with a cuboid box.
clipLine3d
CLIPLINE3D Clip a line with a box and return an edge.
clipPoints3d
CLIPPOINTS3D Clip a set of points by a box or other 3d shapes.
clipPolygon3dHP
CLIPPOLYGON3DHP clip a 3D polygon with Half-space.
clipRay3d
Clip a 3D ray with a box and return a 3D edge.
composeTransforms3d
COMPOSETRANSFORMS3D Concatenate several space transformations.
Contents
GEOM2D Geometry 2D Toolbox Version 1.24 07-Jun-2018 .
createBasisTransform3d
CREATEBASISTRANSFORM3D Compute matrix for transforming a basis into another basis.
createEdge3d
CREATEEDGE3D Create an edge between two 3D points, or from a 3D line.
createLine3d
CREATELINE3D Create a line with various inputs.
createPlane
CREATEPLANE Create a plane in parametrized form.
createRay3d
Create a 3D ray.
createRotation3dLineAngle
CREATEROTATION3DLINEANGLE Create rotation around a line by an angle theta.
createRotationAboutPoint3d
CREATEROTATIONABOUTPOINT3D Rotate about a point using a rotation matrix.
createRotationOx
CREATEROTATIONOX Create the 4x4 matrix of a 3D rotation around x-axis.
createRotationOy
CREATEROTATIONOY Create the 4x4 matrix of a 3D rotation around y-axis.
createRotationOz
CREATEROTATIONOZ Create the 4x4 matrix of a 3D rotation around z-axis.
createRotationVector3d
CREATEROTATIONVECTOR3D Calculates the rotation between two vectors.
createRotationVectorPoint3d
CREATEROTATIONVECTORPOINT3D Calculates the rotation between two vectors. around a point TFM = createRotationVectorPoint3d(A,B,P) returns the transformation to rotate the vector A in t...
createScaling3d
CREATESCALING3D Create the 4x4 matrix of a 3D scaling.
createSphere
CREATESPHERE Create a sphere containing 4 points.
createTranslation3d
CREATETRANSLATION3D Create the 4x4 matrix of a 3D translation.
crossProduct3d
CROSSPRODUCT3D Vector cross product faster than inbuilt MATLAB cross.
cyl2cart
CYL2CART Convert cylindrical to cartesian coordinates.
cylinderSurfaceArea
CYLINDERSURFACEAREA Surface area of a cylinder.
dihedralAngle
DIHEDRALANGLE Compute dihedral angle between 2 planes.
distanceLines3d
DISTANCELINES3D Minimal distance between two 3D lines.
distancePointEdge3d
DISTANCEPOINTEDGE3D Minimum distance between a 3D point and a 3D edge.
distancePointLine3d
DISTANCEPOINTLINE3D Euclidean distance between 3D point and line.
distancePointPlane
DISTANCEPOINTPLANE Signed distance betwen 3D point and plane.
distancePoints3d
DISTANCEPOINTS3D Compute euclidean distance between pairs of 3D Points.
distancePointTriangle3d
DISTANCEPOINTTRIANGLE3D Minimum distance between a 3D point and a 3D triangle.
drawAngleBetweenVectors3d
DRAWANGLEBETWEENVECTORS3D Draw an arc between 2 vectors.
drawArrow3d
DRAWARROW3D plot a quiver of 3D arrows.
drawAxis3d
DRAWAXIS3D Draw a coordinate system and an origin.
drawAxisCube
DRAWAXISCUBE Draw a colored cube representing axis orientation.
drawBox3d
Draw a 3D box defined by coordinate extents.
drawCapsule
Draw a capsule.
drawCircle3d
Draw a 3D circle.
drawCircleArc3d
Draw a 3D circle arc.
drawCube
Draw a 3D centered cube, eventually rotated.
drawCuboid
Draw a 3D cuboid, eventually rotated.
drawCylinder
Draw a cylinder.
drawDome
DRAWDOME Draw a dome (half-sphere, semi-sphere) as a mesh.
drawEdge3d
DRAWEDGE3D Draw 3D edge in the current axes.
drawEllipse3d
DRAWELLIPSE3D Draw a 3D ellipse.
drawEllipseCylinder
DRAWELLIPSECYLINDER Draw a cylinder with ellipse cross-section.
drawEllipsoid
DRAWELLIPSOID Draw a 3D ellipsoid.
drawGrid3d
DRAWGRID3D Draw a 3D grid on the current axis.
drawLabels3d
DRAWLABELS3D Draw text labels at specified 3D positions.
drawLine3d
DRAWLINE3D Draw a 3D line clipped by the current axes.
drawPartialPatch
DRAWPARTIALPATCH draw surface patch, with 2 parametrized surfaces.
drawPlane3d
DRAWPLANE3D Draw a plane clipped by the current axes.
drawPlatform
DRAWPLATFORM Draw a rectangular platform with a given size.
drawPoint3d
DRAWPOINT3D Draw 3D point on the current axis.
drawPolygon3d
DRAWPOLYGON3D Draw a 3D polygon specified by a list of vertex coords.
drawPolyline3d
DRAWPOLYLINE3D Draw a 3D polyline specified by a list of vertex coords.
drawRay3d
Draw a 3D ray on the current axis.
drawSphere
DRAWSPHERE Draw a sphere as a mesh.
drawSphericalEdge
DRAWSPHERICALEDGE Draw an edge on the surface of a sphere.
drawSphericalPolygon
DRAWSPHERICALPOLYGON Draw a spherical polygon.
drawSphericalTriangle
DRAWSPHERICALTRIANGLE Draw a triangle on a sphere.
drawSurfPatch
DRAWSURFPATCH Draw a 3D surface patch, with 2 parametrized surfaces.
drawTorus
DRAWTORUS Draw a torus (3D ring).
drawVector3d
DRAWVECTOR3D Draw vector at a given position.
edgeLength3d
EDGELENGTH3D Return the length of a 3D edge.
edges3d
EDGES3D Description of functions operating on 3D edges.
edgeToLine3d
EDGETOLINE3D Convert a 3D edge to a 3D straight line.
ellipsoidSurfaceArea
ELLIPSOIDSURFACEAREA Approximated surface area of an ellipsoid.
equivalentEllipsoid
Equivalent ellipsoid of a set of 3D points.
eulerAnglesToRotation3d
EULERANGLESTOROTATION3D Convert 3D Euler angles to 3D rotation matrix.
fillPolygon3d
FILLPOLYGON3D Fill a 3D polygon specified by a list of vertex coords.
fillSphericalPolygon
FILLSPHERICALPOLYGON Fill a spherical polygon.
fillSphericalTriangle
FILLSPHERICALTRIANGLE Fill a triangle on a sphere.
fitAffineTransform3d
Compute the affine transform that best register two 3D point sets.
fitCircle3d
FITCIRCLE3D Fit a 3D circle to a set of points.
fitEllipse3d
FITELLIPSE3D Fit an ellipse to a set of points.
fitLine3d
FITLINE3D Fit a 3D line to a set of points.
fitPlane
FITPLANE Fit a 3D plane to a set of points.
fitSphere
FITSPHERE Fit a sphere to 3D points using the least squares approach.
geodesicCylinder
GEODESICCYLINDER computes the geodesic between two points on a cylinder.
hypot3
HYPOT3 Diagonal length of a cuboidal 3D box .
intersectBoxes3d
INTERSECTBOXES3D Intersection of two 3D bounding boxes.
intersectEdgePlane
INTERSECTEDGEPLANE Return intersection point between a plane and a edge.
intersectEdgePolygon3d
Intersection point of a 3D EDGE segment and a 3D polygon.
intersectLineCylinder
INTERSECTLINECYLINDER Compute intersection points between a line and a cylinder.
intersectLinePlane
INTERSECTLINEPLANE Intersection point between a 3D line and a plane.
intersectLinePolygon3d
INTERSECTLINEPOLYGON3D Intersection point of a 3D line and a 3D polygon.
intersectLineSphere
INTERSECTLINESPHERE Return intersection points between a line and a sphere.
intersectLineTriangle3d
INTERSECTLINETRIANGLE3D Intersection point of a 3D line and a 3D triangle.
intersectPlanes
INTERSECTPLANES Return intersection line between 2 planes in space.
intersectPlaneSphere
INTERSECTPLANESPHERE Return intersection circle between a plane and a sphere.
intersectRayPolygon3d
INTERSECTRAYPOLYGON3D Intersection point of a 3D ray and a 3D polygon.
intersectThreePlanes
INTERSECTTHREEPLANES Return intersection point between 3 planes in space.
isBelowPlane
ISBELOWPLANE Test whether a point is below or above a plane.
isCoplanar
ISCOPLANAR Tests input points for coplanarity in 3-space.
isParallel3d
ISPARALLEL3D Check parallelism of two 3D vectors.
isPerpendicular3d
ISPERPENDICULAR3D Check orthogonality of two 3D vectors.
isPlane
ISPLANE Check if input is a plane.
isPointInEllipsoid
Check if a point is located inside a 3D ellipsoid.
isPointOnEdge3d
Test if a 3D point belongs to an edge.
isPointOnLine3d
ISPOINTONLINE3D Test if a 3D point belongs to a 3D line.
isTransform3d
ISTRANSFORM3D Check if input is a affine transformation matrix.
linePosition3d
Return the position of a 3D point projected on a 3D line.
lines3d
LINES3D Description of functions operating on 3D lines.
lineToEdge3d
LINETOEDGE3D Convert a 3D straight line to a 3D finite edge.
medianPlane
MEDIANPLANE Create a plane in the middle of 2 points.
mergeBoxes3d
MERGEBOXES3D Merge 3D boxes, by computing their greatest extent.
midPoint3d
MIDPOINT3D Middle point of two 3D points or of a 3D edge.
normalizeLine3d
NORMALIZELINE3D Normalizes the direction vector of a 3D line.
normalizePlane
NORMALIZEPLANE Normalize parametric representation of a plane.
normalizeVector3d
NORMALIZEVECTOR3D Normalize a 3D vector to have norm equal to 1.
oblateSurfaceArea
OBLATESURFACEAREA Approximated surface area of an oblate ellipsoid.
orientedBox3d
ORIENTEDBOX3D Object-oriented bounding box of a set of 3D points.
parallelLine3d
PARALLELLINE3D Create 3D line parallel to another one.
parallelPlane
PARALLELPLANE Parallel to a plane through a point or at a given distance.
planeNormal
PLANENORMAL Compute the normal to a plane.
planePoint
PLANEPOINT Compute 3D position of a point in a plane.
planePosition
PLANEPOSITION Compute position of a point on a plane.
planes3d
PLANES3D Description of functions operating on 3D planes.
planesBisector
PLANESBISECTOR Bisector plane between two other planes.
points3d
POINTS3D Description of functions operating on 3D points.
polygon3dNormalAngle
POLYGON3DNORMALANGLE Normal angle at a vertex of the 3D polygon.
polygonArea3d
POLYGONAREA3D Area of a 3D polygon.
polygonCentroid3d
POLYGONCENTROID3D Centroid (or center of mass) of a polygon.
polygons3d
POLYGONS3D Description of functions operating on 3D polygons.
projLineOnPlane
PROJLINEONPLANE Return the orthogonal projection of a line on a plane.
projPointOnCircle3d
PROJPOINTONCIRCLE3D Project a 3D point onto a 3D circle.
projPointOnCylinder
PROJPOINTONCYLINDER Project a 3D point onto a cylinder.
projPointOnLine3d
PROJPOINTONLINE3D Project a 3D point orthogonally onto a 3D line.
projPointOnPlane
PROJPOINTONPLANE Return the orthogonal projection of a point on a plane.
prolateSurfaceArea
PROLATESURFACEAREA Approximated surface area of a prolate ellipsoid.
randomAngle3d
RANDOMANGLE3D Return a 3D angle uniformly distributed on unit sphere.
randomPointInBox3d
RANDOMPOINTINBOX3D Generate random point(s) within a 3D box.
recenterTransform3d
RECENTERTRANSFORM3D Change the fixed point of an affine 3D transform.
registerPoints3dAffine
Fit 3D affine transform using iterative algorithm.
reverseLine3d
REVERSELINE3D Return same 3D line but with opposite orientation.
reversePlane
REVERSEPLANE Return same 3D plane but with opposite orientation.
revolutionSurface
REVOLUTIONSURFACE Create a surface of revolution from a planar curve.
rotation3dAxisAndAngle
ROTATION3DAXISANDANGLE Determine axis and angle of a 3D rotation matrix.
rotation3dToEulerAngles
ROTATION3DTOEULERANGLES Extract Euler angles from a rotation matrix.
sph2cart2d
SPH2CART2D Convert spherical coordinates to cartesian coordinates in degrees.
sph2cart2
SPH2CART2 Convert spherical coordinates to cartesian coordinates.
spheres
SPHERES Description of functions operating on 3D spheres.
sphericalAngle
SPHERICALANGLE Compute angle between points on the sphere.
sphericalVoronoiDomain
SPHERICALVORONOIDOMAIN Compute a spherical voronoi domain.
surfaceCurvature
SURFACECURVATURE Curvature on a surface from angle and principal curvatures.
transformLine3d
TRANSFORMLINE3D Transform a 3D line with a 3D affine transform.
transformPlane3d
TRANSFORMPLANE3D Transform a 3D plane with a 3D affine transform.
transformPoint3d
TRANSFORMPOINT3D Transform a point with a 3D affine transform.
transforms3d
TRANSFORMS3D Conventions for manipulating 3D affine transforms.
transformVector3d
TRANSFORMVECTOR3D Transform a vector with a 3D affine transform.
triangleArea3d
TRIANGLEAREA3D Area of a 3D triangle.
vectorAngle3d
VECTORANGLE3D Angle between two 3D vectors.
vectorCross3d
VECTORCROSS3D Vector cross product faster than inbuilt MATLAB cross.
vectorNorm3d
VECTORNORM3D Norm of a 3D vector or of set of 3D vectors.
vectors3d
VECTORS3D Description of functions operating on 3D vectors.

polygons2d

cart2geod
CART2GEOD Convert cartesian coordinates to geodesic coord.
clipPolygonHP
CLIPPOLYGONHP Clip a polygon with a Half-plane defined by a directed line.
clipPolygon
CLIPPOLYGON Clip a polygon with a rectangular box.
clipPolyline
CLIPPOLYLINE Clip an open polyline with a rectangular box.
Contents
GEOM2D Geometry 2D Toolbox Version 1.24 07-Jun-2018 .
contourMatrixToPolylines
CONTOURMATRIXTOPOLYLINES Converts a contour matrix array into a polyline set.
convexHull
CONVEXHULL Convex hull of a set of points.
convexification
CONVEXIFICATION Compute the convexification of a polygon.
curvature
CURVATURE Estimate curvature of a polyline defined by points.
curveCMoment
CURVECMOMENT Compute centered inertia moment of a 2D curve.
curveCSMoment
CURVECSMOMENT Compute centered scaled moment of a 2D curve.
curveMoment
CURVEMOMENT Compute inertia moment of a 2D curve.
densifyPolygon
DENSIFYPOLYGON Add several points on each edge of the polygon.
distancePointPolygon
DISTANCEPOINTPOLYGON Shortest distance between a point and a polygon.
distancePointPolyline
DISTANCEPOINTPOLYLINE Compute shortest distance between a point and a polyline.
distancePolygons
DISTANCEPOLYGONS Compute the shortest distance between 2 polygons.
distancePolygonsNoCross
DISTANCEPOLYGONSNOCROSS Compute the shortest distance between 2 polygons.
distancePolylines
DISTANCEPOLYLINES Compute the shortest distance between 2 polylines.
drawPolygon
DRAWPOLYGON Draw a polygon specified by a list of points.
drawPolyline
DRAWPOLYLINE Draw a polyline specified by a list of points.
drawVertices
DRAWVERTICES Draw the vertices of a polygon or polyline.
expandPolygon
EXPANDPOLYGON Expand a polygon by a given (signed) distance.
fillPolygon
FILLPOLYGON Fill a polygon specified by a list of points.
findPoint
FINDPOINT Find index of a point in an set from its coordinates.
geod2cart
GEOD2CART Convert geodesic coordinates to cartesian coord.
intersectEdgePolygon
INTERSECTEDGEPOLYGON Intersection point of an edge with a polygon.
intersectLinePolygon
INTERSECTLINEPOLYGON Intersection points between a line and a polygon.
intersectLinePolyline
INTERSECTLINEPOLYLINE Intersection points between a line and a polyline.
intersectPolylines
INTERSECTPOLYLINES Find the common points between 2 polylines.
intersectRayPolygon
INTERSECTRAYPOLYGON Intersection points between a ray and a polygon.
isPointInPolygon
ISPOINTINPOLYGON Test if a point is located inside a polygon.
isPointOnPolyline
ISPOINTONPOLYLINE Test if a point belongs to a polyline.
medialAxisConvex
MEDIALAXISCONVEX Compute medial axis of a convex polygon.
minimumCaliperDiameter
MINIMUMCALIPERDIAMETER Minimum caliper diameter of a set of points.
parametrize
PARAMETRIZE Parametrization of a polyline, based on edges lengths.
pointSetsAverage
POINTSETSAVERAGE Compute the average of several point sets.
polygonArea
Compute the signed area of a polygon.
polygonBounds
POLYGONBOUNDS Compute the bounding box of a polygon.
polygonCentroid
POLYGONCENTROID Compute the centroid (center of mass) of a polygon.
polygonContains
POLYGONCONTAINS Test if a point is contained in a multiply connected polygon.
polygonCurvature
POLYGONCURVATURE Estimate curvature on polygon vertices using polynomial fit.
polygonEdges
POLYGONEDGES Return the edges of a simple or multiple polygon.
polygonEquivalentEllipse
Compute equivalent ellipse with same second order moments as polygon.
polygonInertiaEllipse
POLYGONINERTIAELLIPSE Compute ellipse with same inertia moments as polygon.
polygonLength
POLYGONLENGTH Perimeter of a polygon.
polygonLoops
POLYGONLOOPS Divide a possibly self-intersecting polygon into a set of simple loops.
polygonNormalAngle
Normal angle at each vertex of a polygon.
polygonOuterNormal
Outer normal vector for a given vertex(ices).
polygonPoint
POLYGONPOINT Extract a point from a polygon.
polygonSecondAreaMoments
POLYGONSECONDAREAMOMENTS Compute second-order area moments of a polygon.
polygonSelfIntersections
POLYGONSELFINTERSECTIONS Find self-intersection points of a polygon.
polygonSignature
POLYGONSIGNATURE Polar signature of a polygon (polar distance to origin).
polygonSkeleton
Skeletonization of a polygon with a dense distribution of vertices.
polygonSubcurve
Extract a portion of a polygon.
polygonSymmetryAxis
POLYGONSYMMETRYAXIS Try to identify symmetry axis of polygon.
polygonToRow
POLYGONTOROW Convert polygon coordinates to a row vector.
polygonVertices
POLYGONVERTICES Extract all vertices of a (multi-)polygon.
polylineCentroid
POLYLINECENTROID Compute centroid of a curve defined by a series of points.
polylineLength
POLYLINELENGTH Return length of a polyline given as a list of points.
polylinePoint
POLYLINEPOINT Extract a point from a polyline.
polylineSelfIntersections
POLYLINESELFINTERSECTIONS Find self-intersection points of a polyline.
polylineSubcurve
Extract a portion of a polyline.
projPointOnPolygon
PROJPOINTONPOLYGON Compute position of a point projected on a polygon.
projPointOnPolyline
PROJPOINTONPOLYLINE Compute position of a point projected on a polyline.
randomPointInPolygon
RANDOMPOINTINPOLYGON Generate random point(s) in a polygon.
readPolygonSet
READPOLYGONSET Read a set of simple polygons stored in a file.
removeMultipleVertices
REMOVEMULTIPLEVERTICES Remove multiple vertices of a polygon or polyline.
resamplePolygonByLength
RESAMPLEPOLYGONBYLENGTH Resample a polygon with a fixed sampling step.
resamplePolygon
RESAMPLEPOLYGON Distribute N points equally spaced on a polygon.
resamplePolylineByLength
RESAMPLEPOLYLINEBYLENGTH Resample a polyline with a fixed sampling step.
resamplePolyline
RESAMPLEPOLYLINE Distribute N points equally spaced on a polyline.
reversePolygon
REVERSEPOLYGON Reverse a polygon, by iterating vertices from the end.
reversePolyline
REVERSEPOLYLINE Reverse a polyline, by iterating vertices from the end.
rowToPolygon
ROWTOPOLYGON Create a polygon from a row vector.
signatureToPolygon
SIGNATURETOPOLYGON Reconstruct a polygon from its polar signature.
simplifyPolygon
SIMPLIFYPOLYGON Douglas-Peucker simplification of a polygon.
simplifyPolyline
SIMPLIFYPOLYLINE Douglas-Peucker simplification of a polyline.
smoothPolygon
SMOOTHPOLYGON Smooth a polygon using local averaging.
smoothPolyline
SMOOTHPOLYLINE Smooth a polyline using local averaging.
splitPolygons
SPLITPOLYGONS Convert a NaN separated polygon list to a cell array of polygons.
steinerPoint
STEINERPOINT Compute steiner point (weighted centroid) of a polygon.
steinerPolygon
STEINERPOLYGON Create a Steiner polygon from a set of vectors.
supportFunction
SUPPORTFUNCTION Compute support function of a polygon.
triangulatePolygon
TRIANGULATEPOLYGON Compute a triangulation of the polygon.
writePolygonSet
WRITEPOLYGONSET Write a set of simple polygons into a file.

geom2d

angle2Points
ANGLE2POINTS Compute horizontal angle between 2 points.
angle3Points
ANGLE3POINTS Compute oriented angle made by 3 points.
angleAbsDiff
ANGLEABSDIFF Absolute difference between two angles.
angleDiff
ANGLEDIFF Difference between two angles.
angles2d
Description of functions for manipulating angles.
angleSort
ANGLESORT Sort points in the plane according to their angle to origin.
bisector
BISECTOR Return the bisector of two lines, or 3 points.
boundingBox
BOUNDINGBOX Bounding box of a set of points.
boxes2d
BOXES2D Description of functions operating on bounding boxes.
boxToPolygon
BOXTOPOLYGON Convert a bounding box to a square polygon.
boxToRect
BOXTORECT Convert box data to rectangle data.
cartesianLine
CARTESIANLINE Create a straight line from cartesian equation coefficients.
centeredEdgeToEdge
CENTEREDEDGETOEDGE Convert a centered edge to a two-points edge.
centroid
CENTROID Compute centroid (center of mass) of a set of points.
circleArcToPolyline
CIRCLEARCTOPOLYLINE Convert a circle arc into a series of points.
circles2d
CIRCLES2D Description of functions operating on circles.
circleToPolygon
CIRCLETOPOLYGON Convert a circle into a series of points.
circumCenter
CIRCUMCENTER Circumcenter of three points.
circumCircle
CIRCUMCIRCLE Circumscribed circle of three points.
clipEdge
CLIPEDGE Clip an edge with a rectangular box.
clipLine
CLIPLINE Clip a line with a box.
clipPoints
CLIPPOINTS Clip a set of points by a box.
clipRay
Clip a ray with a box.
Contents
GEOM2D Geometry 2D Toolbox Version 1.24 07-Jun-2018 .
crackPattern2
CRACKPATTERN2 Create a (bounded) crack pattern tessellation.
crackPattern
CRACKPATTERN Create a (bounded) crack pattern tessellation.
createBasisTransform
CREATEBASISTRANSFORM Compute matrix for transforming a basis into another basis.
createCircle
CREATECIRCLE Create a circle from 2 or 3 points.
createDirectedCircle
CREATEDIRECTEDCIRCLE Create a directed circle.
createEdge
CREATEEDGE Create an edge between two points, or from a line.
createHomothecy
CREATEHOMOTHECY Create the the 3x3 matrix of an homothetic transform.
createLine
CREATELINE Create a straight line from 2 points, or from other inputs.
createLineReflection
CREATELINEREFLECTION Create the the 3x3 matrix of a line reflection.
createRay
CREATERAY Create a ray (half-line), from various inputs.
createRotation90
CREATEROTATION90 Matrix of a rotation for 90 degrees multiples.
createRotation
CREATEROTATION Create the 3*3 matrix of a rotation.
createScaling
CREATESCALING Create the 3*3 matrix of a scaling in 2 dimensions.
createTranslation
CREATETRANSLATION Create the 3*3 matrix of a translation.
createVector
CREATEVECTOR Create a vector from two points.
cubicBezierToPolyline
CUBICBEZIERTOPOLYLINE Compute equivalent polyline from bezier curve control.
distancePointEdge
DISTANCEPOINTEDGE Minimum distance between a point and an edge.
distancePointLine
DISTANCEPOINTLINE Minimum distance between a point and a line.
distancePoints
DISTANCEPOINTS Compute distance between two points.
drawArrow
DRAWARROW Draw an arrow on the current axis.
drawBezierCurve
DRAWBEZIERCURVE Draw a cubic bezier curve defined by 4 control points.
drawBox
DRAWBOX Draw a box defined by coordinate extents.
drawCenteredEdge
DRAWCENTEREDEDGE Draw an edge centered on a point.
drawCircleArc
DRAWCIRCLEARC Draw a circle arc on the current axis.
drawCircle
DRAWCIRCLE Draw a circle on the current axis.
drawEdge
DRAWEDGE Draw an edge given by 2 points.
drawEllipseArc
DRAWELLIPSEARC Draw an ellipse arc on the current axis.
drawEllipse
DRAWELLIPSE Draw an ellipse on the current axis.
drawLabels
Draw labels at specified positions.
drawLine
DRAWLINE Draw a straight line clipped by the current axis.
drawOrientedBox
DRAWORIENTEDBOX Draw centered oriented rectangle.
drawParabola
DRAWPARABOLA Draw a parabola on the current axis.
drawPoint
DRAWPOINT Draw the point on the axis.
drawRay
DRAWRAY Draw a ray on the current axis.
drawRect
DRAWRECT Draw rectangle on the current axis.
drawShape
DRAWSHAPE Draw various types of shapes (circles, polygons...).
drawVector
DRAWVECTOR Draw vector at a given position.
edgeAngle
EDGEANGLE Return angle of edge.
edgeLength
EDGELENGTH Return length of an edge.
edgePosition
EDGEPOSITION Return position of a point on an edge.
edges2d
EDGES2D Description of functions operating on planar edges.
edgeToLine
EDGETOLINE Convert an edge to a straight line.
edgeToPolyline
EDGETOPOLYLINE Convert an edge to a polyline with a given number of segments.
ellipsePerimeter
ELLIPSEPERIMETER Perimeter of an ellipse.
ellipses2d
ELLIPSES2D Description of functions operating on ellipses.
ellipseToPolygon
ELLIPSETOPOLYGON Convert an ellipse into a series of points.
enclosingCircle
ENCLOSINGCIRCLE Find the minimum circle enclosing a set of points.
equivalentEllipse
Equivalent ellipse of a set of points.
findClosestPoint
FINDCLOSESTPOINT Find index of closest point in an array.
fitAffineTransform2d
Compute the affine transform that best register two point sets.
fitPolynomialTransform2d
FITPOLYNOMIALTRANSFORM2D Coefficients of polynomial transform between two point sets.
hausdorffDistance
HAUSDORFFDISTANCE Hausdorff distance between two point sets.
hexagonalGrid
HEXAGONALGRID Generate hexagonal grid of points in the plane.
inertiaEllipse
INERTIAELLIPSE Inertia ellipse of a set of points.
intersectBoxes
INTERSECTBOXES Intersection of two bounding boxes.
intersectCircles
INTERSECTCIRCLES Intersection points of two circles.
intersectEdges
INTERSECTEDGES Return all intersections between two set of edges.
intersectLineCircle
Intersection point(s) of a line and a circle.
intersectLineEdge
INTERSECTLINEEDGE Return intersection between a line and an edge.
intersectLines
INTERSECTLINES Return all intersection points of N lines in 2D.
isCounterClockwise
Compute the relative orientation of 3 points.
isLeftOriented
ISLEFTORIENTED Test if a point is on the left side of a line.
isParallel
ISPARALLEL Check parallelism of two vectors.
isPerpendicular
ISPERPENDICULAR Check orthogonality of two vectors.
isPointInCircle
ISPOINTINCIRCLE Test if a point is located inside a given circle.
isPointInEllipse
ISPOINTINELLIPSE Check if a point is located inside a given ellipse.
isPointInTriangle
ISPOINTINTRIANGLE Test if a point is located inside a triangle.
isPointOnCircle
ISPOINTONCIRCLE Test if a point is located on a given circle.
isPointOnEdge
ISPOINTONEDGE Test if a point belongs to an edge.
isPointOnLine
ISPOINTONLINE Test if a point belongs to a line.
isPointOnRay
ISPOINTONRAY Test if a point belongs to a ray.
lineAngle
LINEANGLE Computes angle between two straight lines.
lineFit
LINEFIT Fit a straight line to a set of points.
linePosition
LINEPOSITION Position of a point on a line.
lines2d
LINES2D Description of functions operating on planar lines.
lineToEdge
LINETOEDGE Convert a straight line to a finite edge.
medianLine
MEDIANLINE Create a median line between two points.
mergeBoxes
MERGEBOXES Merge two boxes, by computing their greatest extent.
mergeClosePoints
MERGECLOSEPOINTS Merge points that are closer than a given distance.
midPoint
MIDPOINT Middle point of two points or of an edge.
minDistancePoints
Minimal distance between several points.
nndist
NNDIST Nearest-neighbor distances of each point in a set.
normalizeAngle
NORMALIZEANGLE Normalize an angle value within a 2*PI interval.
normalize
NORMALIZE Normalize a vector.
normalizeVector
NORMALIZEVECTOR Normalize a vector to have norm equal to 1.
orientedBox
ORIENTEDBOX Minimum-width oriented bounding box of a set of points.
orientedBoxToPolygon
ORIENTEDBOXTOPOLYGON Convert an oriented box to a polygon (set of vertices).
orthogonalLine
ORTHOGONALLINE Create a line orthogonal to another one through a point.
parallelEdge
PARALLELEDGE Edge parallel to another edge.
parallelLine
PARALLELLINE Create a line parallel to another one.
pointOnLine
POINTONLINE Create a point on a line at a given position on the line.
points2d
POINTS2D Description of functions operating on points.
polarPoint
POLARPOINT Create a point from polar coordinates (rho + theta).
polynomialTransform2d
POLYNOMIALTRANSFORM2D Apply a polynomial transform to a set of points.
principalAxes
PRINCIPALAXES Principal axes of a set of ND points.
principalAxesTransform
Align a set of points along its principal axes.
projPointOnLine
PROJPOINTONLINE Project of a point orthogonally onto a line.
radicalAxis
RADICALAXIS Compute the radical axis (or radical line) of 2 circles.
randomPointInBox
RANDOMPOINTINBOX Generate random point within a box.
rays2d
RAYS2D Description of functions operating on planar rays.
rectToBox
RECTTOBOX Convert rectangle data to box data.
rectToPolygon
RECTTOPOLYGON Convert a rectangle into a polygon (set of vertices).
registerICP
REGISTERICP Fit affine transform by Iterative Closest Point algorithm.
reverseEdge
REVERSEEDGE Intervert the source and target vertices of edge.
reverseLine
REVERSELINE Return same line but with opposite orientation.
rotateVector
ROTATEVECTOR Rotate a vector by a given angle.
squareGrid
SQUAREGRID Generate equally spaces points in plane.
transformEdge
TRANSFORMEDGE Transform an edge with an affine transform.
transformLine
TRANSFORMLINE Transform a line with an affine transform.
transformPoint
Apply an affine transform to a point or a point set.
transforms2d
TRANSFORMS2D Description of functions operating on transforms.
transformVector
TRANSFORMVECTOR Transform a vector with an affine transform.
triangleArea
TRIANGLEAREA Signed area of a triangle.
triangleGrid
TRIANGLEGRID Generate triangular grid of points in the plane.
vectorAngle
Horizontal angle of a vector, or angle between 2 vectors.
vectorNorm
Compute norm of a vector, or of a set of vectors.
vectors2d
VECTORS2D Description of functions operating on plane vectors.

meshes3d

averageMesh
Compute average mesh from a list of meshes.
boxToMesh
BOXTOMESH Convert a box into a quad mesh with the same size.
checkMeshAdjacentFaces
CHECKMESHADJACENTFACES Check if adjacent faces of a mesh have similar orientation.
clipConvexPolyhedronHP
CLIPCONVEXPOLYHEDRONHP Clip a convex polyhedron by a plane.
clipMeshVertices
CLIPMESHVERTICES Clip vertices of a surfacic mesh and remove outer faces.
collapseEdgesWithManyFaces
removes mesh edges adjacent to more than two faces
concatenateMeshes
CONCATENATEMESHES Concatenate multiple meshes.
Contents
GEOM2D Geometry 2D Toolbox Version 1.24 07-Jun-2018 .
createCube
CREATECUBE Create a 3D mesh representing the unit cube.
createCubeOctahedron
CREATECUBEOCTAHEDRON Create a 3D mesh representing a cube-octahedron.
createDodecahedron
CREATEDODECAHEDRON Create a 3D mesh representing a dodecahedron.
createDurerPolyhedron
CREATEDURERPOLYHEDRON Create a mesh representing Durer's polyhedron .
createIcosahedron
CREATEICOSAHEDRON Create a 3D mesh representing an Icosahedron.
createMengerSponge
CREATEMENGERSPONGE Create a cube with an inside cross removed.
createOctahedron
CREATEOCTAHEDRON Create a 3D mesh representing an octahedron.
createRhombododecahedron
CREATERHOMBODODECAHEDRON Create a 3D mesh representing a rhombododecahedron.
createSoccerBall
CREATESOCCERBALL Create a 3D mesh representing a soccer ball.
createStellatedMesh
CREATESTELLATEDMESH Replaces each face of a mesh by a pyramid.
createTetrahedron
CREATETETRAHEDRON Create a 3D mesh representing a tetrahedron.
createTetrakaidecahedron
CREATETETRAKAIDECAHEDRON Create a 3D mesh representing a tetrakaidecahedron.
curveToMesh
Create a mesh surrounding a 3D curve.
cutMeshByPlane
CUTMESHBYPLANE Cut a mesh by a plane.
cylinderMesh
Create a 3D mesh representing a cylinder.
distancePointMesh
DISTANCEPOINTMESH Shortest distance between a (3D) point and a triangle mesh.
drawFaceNormals
DRAWFACENORMALS Draw normal vector of each face in a mesh.
drawMesh
DRAWMESH Draw a 3D mesh defined by vertex and face arrays.
drawPolyhedron
DRAWPOLYHEDRON Draw polyhedron defined by vertices and faces.
ellipsoidMesh
ELLIPSOIDMESH Convert a 3D ellipsoid to face-vertex mesh representation.
ensureManifoldMesh
ENSUREMANIFOLDMESH Apply several simplification to obtain a manifold mesh.
fillMeshFaces
Fill the faces of a mesh with the specified colors.
intersectEdgeMesh3d
Intersection points of a 3D edge with a mesh.
intersectLineMesh3d
Intersection points of a 3D line with a mesh.
intersectPlaneMesh
Compute the polygons resulting from plane-mesh intersection.
isManifoldMesh
ISMANIFOLDMESH Check whether the input mesh may be considered as manifold.
isPointInMesh
ISPOINTINMESH Check if a point is inside a 3D mesh.
mergeCoplanarFaces
MERGECOPLANARFACES Merge coplanar faces of a polyhedral mesh.
mergeMeshVertices
MERGEMESHVERTICES Merge two vertices and removes eventual degenerated faces.
meshAdjacencyMatrix
MESHADJACENCYMATRIX Compute adjacency matrix of a mesh from set of faces.
meshBoundaryEdgeIndices
MESHBOUNDARYEDGEINDICES Indices of boundary edges of a mesh.
meshBoundary
MESHBOUNDARY Boundary of a mesh as a collection of 3D line strings.
meshBoundaryVertexIndices
MESHBOUNDARYVERTEXINDICES Indices of boundary vertices of a mesh.
meshComplement
Reverse the normal of each face in the mesh.
meshDihedralAngles
MESHDIHEDRALANGLES Dihedral at edges of a polyhedal mesh.
meshEdgeFaces
ok
meshEdgeLength
ok
meshEdges
MESHEDGES Computes array of edge vertex indices from face array.
meshFaceAdjacency
MESHFACEADJACENCY Compute adjacency list of face around each face.
meshFaceAreas
MESHFACEAREAS Surface area of each face of a mesh.
meshFaceCentroids
MESHFACECENTROIDS Compute centroids of faces in a mesh.
meshFaceEdges
MESHFACEEDGES Computes edge indices of each face.
meshFace
MESHFACE Return the vertex indices of a face in a mesh.
meshFaceNormals
MESHFACENORMALS Compute normal vector of faces in a 3D mesh.
meshFaceNumber
MESHFACENUMBER Returns the number of faces in this mesh.
meshFacePolygons
MESHFACEPOLYGONS Returns the set of polygons that constitutes a mesh.
meshSilhouette
MESHSILHOUETTE Compute the 2D outline of a 3D mesh on an arbitrary plane.
meshSurfaceArea
Surface area of a polyhedral mesh.
meshVertexClustering
MESHVERTEXCLUSTERING Simplifies a mesh using vertex clustering.
meshVertexNormals
MESHVERTEXNORMALS Compute normals to a mesh vertices.
meshVolume
(Signed) volume of the space enclosed by a polygonal mesh.
minConvexHull
MINCONVEXHULL Return the unique minimal convex hull of a set of 3D points.
polyhedra
POLYHEDRA Index of classical polyhedral meshes.
polyhedronCentroid
ok
polyhedronMeanBreadth
POLYHEDRONMEANBREADTH Mean breadth of a convex polyhedron.
polyhedronNormalAngle
POLYHEDRONNORMALANGLE Compute normal angle at a vertex of a 3D polyhedron.
polyhedronSlice
POLYHEDRONSLICE Intersect a convex polyhedron with a plane.
readMesh
Read a 3D mesh by inferring format from file name.
readMesh_off
Read mesh data stored in OFF format.
readMesh_ply
Read mesh data stored in PLY (Stanford triangle) format.
readMesh_stl
READMESH_STL Read mesh data stored in STL format.
removeDuplicateFaces
REMOVEDUPLICATEFACES Remove duplicate faces in a face array.
removeInvalidBorderFaces
REMOVEINVALIDBORDERFACES Remove faces whose edges are connected to 3, 3, and 1 faces.
removeMeshEars
REMOVEMESHEARS Remove vertices that are connected to only one face.
removeMeshFaces
REMOVEMESHFACES Remove faces from a mesh by face indices. [V2, F2] = removeMeshFaces(V, F, FI) removes faces from the mesh by the face indices FI into faces F of the mesh.
removeMeshVertices
REMOVEMESHVERTICES Remove vertices and associated faces from a mesh.
smoothMesh
SMOOTHMESH Smooth mesh by replacing each vertex by the average of its neighbors.
sphereMesh
Create a 3D mesh representing a sphere.
splitMesh
SPLITMESH Return the connected components of a mesh.
steinerPolytope
STEINERPOLYTOPE Create a steiner polytope from a set of vectors.
subdivideMesh
SUBDIVIDEMESH Subdivides each face of the mesh.
surfToMesh
Convert surface grids into face-vertex mesh.
tetrahedronVolume
TETRAHEDRONVOLUME Signed volume of a tetrahedron.
torusMesh
TORUSMESH Create a 3D mesh representing a torus.
transformMesh
TRANSFORMMESH Applies a 3D affine transform to a mesh.
triangulateCurvePair
TRIANGULATECURVEPAIR Compute triangulation between a pair of 3D open curves.
triangulateFaces
TRIANGULATEFACES Convert face array to an array of triangular faces.
triangulatePolygonPair
Compute triangulation between a pair of 3D closed curves.
trimeshEdgeFaces
TRIMESHEDGEFACES Compute index of faces adjacent to each edge of a triangular mesh.
trimeshMeanBreadth
TRIMESHMEANBREADTH Mean breadth of a triangular mesh.
trimeshSurfaceArea
TRIMESHSURFACEAREA Surface area of a triangular mesh.
trimMesh
TRIMMESH Reduce memory footprint of a polygonal mesh.
vertexNormal
VERTEXNORMAL Compute normals to a mesh vertices.
writeMesh
Write 3D mesh data by inferring format from file name.
writeMesh_off
WRITEMESH_OFF Write a mesh into a text file in OFF format.
writeMesh_ply
WRITEMESH_PLY Write a mesh into a file in PLY format.
writeMesh_stl
WRITEMESH_STL Write mesh data in the STL format.

utils

isAxisHandle
ISAXISHANDLE Check if the input corresponds to a valid axis handle.

graphs

addSquareFace
ADDSQUAREFACE Add a (square) face defined from its vertices to a graph.
adjacencyListToEdges
Convert an adjacency list to an edge array.
boundaryGraph
BOUNDARYGRAPH Get boundary of image as a graph.
boundedCentroidalVoronoi2d
BOUNDEDCENTROIDALVORONOI2D Create a 2D Centroidal Voronoi Tesselation in a box.
boundedVoronoi2d
BOUNDEDVORONOI2D Return a bounded voronoi diagram as a graph structure.
centroidalVoronoi2d
CENTROIDALVORONOI2D Centroidal Voronoi tesselation within a polygon.
centroidalVoronoi2d_MC
CENTROIDALVORONOI2D_MC Centroidal Voronoi tesselation by Monte-Carlo.
clipGraph
CLIPGRAPH Clip a graph with a rectangular area.
clipGraphPolygon
CLIPGRAPHPOLYGON Clip a graph with a polygon.
clipMesh2dPolygon
CLIPMESH2DPOLYGON Clip a planar mesh with a polygon.
Contents
GEOM2D Geometry 2D Toolbox Version 1.24 07-Jun-2018 .
cvtIterate
CVTITERATE Update germs of a CVT using random points with given density.
cvtUpdate
CVTUPDATE Update germs of a CVT with given points.
delaunayGraph
DELAUNAYGRAPH Graph associated to Delaunay triangulation of input points.
drawDigraph
DRAWDIGRAPH Draw a directed graph, given as a set of vertices and edges.
drawDirectedEdges
DRAWDIRECTEDEDGES Draw edges with arrow indicating direction.
drawEdgeLabels
DRAWEDGELABELS Draw values associated to graph edges.
drawGraphEdges
Draw edges of a graph.
drawGraph
DRAWGRAPH Draw a graph, given as a set of vertices and edges.
drawNodeLabels
DRAWNODELABELS Draw values associated to graph nodes.
drawSquareMesh
ok
euclideanMST
EUCLIDEANMST Build euclidean minimal spanning tree of a set of points.
fillGraphFaces
FILLGRAPHFACES Fill faces of a graph with specified color.
gabrielGraph
GABRIELGRAPH Gabriel Graph of a set of points.
gcontour2d
GCONTOUR2D Creates contour graph of a 2D binary image.
gcontour3d
GCONTOUR3D Create contour graph of a 3D binary image.
grAdjacentEdges
GRADJACENTEDGES Find list of edges adjacent to a given node.
grAdjacentNodes
GRADJACENTNODES Find list of nodes adjacent to a given node.
graph2Contours
ok
graphCenter
GRAPHCENTER Center of a graph.
graphDiameter
GRAPHDIAMETER Diameter of a graph.
graphPeripheralVertices
GRAPHPERIPHERALVERTICES Peripheral vertices of a graph.
graphRadius
GRAPHRADIUS Radius of a graph.
grClose
GRCLOSE Morphological closing on graph.
grDilate
GRDILATE Morphological dilation on graph.
grEdgeLengths
GREDGELENGTHS Compute length of edges in a geometric graph.
grErode
GRERODE Morphological erosion on graph.
grFaceToPolygon
GRFACETOPOLYGON Compute the polygon corresponding to a graph face.
grFindGeodesicPath
GRFINDGEODESICPATH Find a geodesic path between two nodes in the graph.
grFindMaximalLengthPath
GRFINDMAXIMALLENGTHPATH Find a path that maximizes sum of edge weights.
grLabel
GRLABEL Associate a label to each connected component of the graph.
grMean
Compute mean value from neighbour nodes.
grMedian
Compute median value from neighbour nodes.
grMergeMultipleEdges
GRMERGEMULTIPLEEDGES Remove all edges sharing the same extremities.
grMergeMultipleNodes
GRMERGEMULTIPLENODES Simplify a graph by merging multiple nodes.
grMergeNodeClusters
GRMERGENODECLUSTERS Merge cluster of connected nodes in a graph.
grMergeNodes
GRMERGENODES Merge two (or more) nodes in a graph.
grMergeNodesMedian
GRMERGENODESMEDIAN Replace several nodes by their median coordinate.
grNodeDegree
GRNODEDEGREE Degree of a node in a (undirected) graph.
grNodeInnerDegree
GRNODEINNERDEGREE Inner degree of a node in a graph.
grNodeOuterDegree
GRNODEOUTERDEGREE Outer degree of a node in a graph.
grOpen
GROPEN Morphological opening on graph.
grOppositeNode
GROPPOSITENODE Return opposite node in an edge.
grPropagateDistance
GRPROPAGATEDISTANCE Propagates distances from a vertex to other vertices.
grRemoveEdge
GRREMOVEEDGE Remove an edge in a graph.
grRemoveEdges
GRREMOVEEDGES Remove several edges from a graph.
grRemoveMultiplePoints
GRREMOVEMULTIPLEPOINTS Remove groups of close nodes in a graph.
grRemoveNode
GRREMOVENODE Remove a node in a graph.
grRemoveNodes
GRREMOVENODES Remove several nodes in a graph.
grShortestPath
GRSHORTESTPATH Find a shortest path between two nodes in the graph.
grSimplifyBranches
GRSIMPLIFYBRANCHES Replace branches of a graph by single edges.
grSimplifyBranches_old
GRSIMPLIFYBRANCHES_OLD Replace branches of a graph by single edges.
grVertexEccentricity
GRVERTEXECCENTRICITY Eccentricity of vertices in the graph.
imageGraph
IMAGEGRAPH Create equivalent graph of a binary image.
knnGraph
KNNGRAPH Create the k-nearest neighbors graph of a set of points.
mergeGraphs
MERGEGRAPHS Merge two graphs, by adding nodes, edges and faces lists.
meshEnergy
Computes the energy of a tesselation, as the sum of second area moments.
patchGraph
ok
prim_mst
PRIM_MST Minimal spanning tree by Prim's algorithm.
pruneGraph
PRUNEGRAPH Remove all edges with a terminal vertex.
quiverToGraph
QUIVERTOGRAPH Converts quiver data to quad mesh.
readGraph
READGRAPH Read a graph from a text file.
relativeNeighborhoodGraph
RELATIVENEIGHBORHOODGRAPH Relative Neighborhood Graph of a set of points.
voronoi2d
VORONOI2D Compute a voronoi diagram as a graph structure.
writeGraph
WRITEGRAPH Write a graph to an ascii file.

polynomialCurves2d

Contents
GEOM2D Geometry 2D Toolbox Version 1.24 07-Jun-2018 .
drawPolynomialCurve
DRAWPOLYNOMIALCURVE Draw a polynomial curve approximation.
polyfit2
POLYFIT2 Polynomial approximation of a curve.
polynomialCurveCentroid
POLYNOMIALCURVECENTROID Compute the centroid of a polynomial curve.
polynomialCurveCurvature
POLYNOMIALCURVECURVATURE Compute the local curvature of a polynomial curve.
polynomialCurveCurvatures
POLYNOMIALCURVECURVATURES Compute curvatures of a polynomial revolution surface.
polynomialCurveDerivative
POLYNOMIALCURVEDERIVATIVE Compute derivative vector of a polynomial curve.
polynomialCurveFit
POLYNOMIALCURVEFIT Fit a polynomial curve to a series of points.
polynomialCurveLength
POLYNOMIALCURVELENGTH Compute the length of a polynomial curve.
polynomialCurveNormal
POLYNOMIALCURVENORMAL Compute the normal of a polynomial curve.
polynomialCurvePoint
POLYNOMIALCURVEPOINT Compute point corresponding to a position.
polynomialCurvePosition
POLYNOMIALCURVEPOSITION Compute position on a curve for a given length.
polynomialCurveProjection
POLYNOMIALCURVEPROJECTION Projection of a point on a polynomial curve.
polynomialCurveSetFit
POLYNOMIALCURVESETFIT Fit a set of polynomial curves to a segmented image.
polynomialDerivate
POLYNOMIALDERIVATE Derivate a polynomial.

Package: matgeom