►Cgeos::operation::cluster::AbstractClusterFinder | |
Cgeos::operation::cluster::DBSCANClusterFinder | |
Cgeos::operation::cluster::EnvelopeDistanceClusterFinder | |
Cgeos::operation::cluster::EnvelopeIntersectsClusterFinder | |
Cgeos::operation::cluster::GeometryDistanceClusterFinder | |
Cgeos::operation::cluster::GeometryIntersectsClusterFinder | |
►Cgeos::index::strtree::AbstractSTRtree | Base class for STRtree and SIRtree |
Cgeos::index::strtree::SIRtree | One-dimensional version of an STR-packed R-tree |
Cgeos::index::strtree::STRtree | A query-only R-tree created using the Sort-Tile-Recursive (STR) algorithm. For two-dimensional spatial data |
Cgeos::operation::relateng::AdjacentEdgeLocator | |
Cgeos::algorithm::Angle | Utility functions for working with angles |
Cgeos::index::bintree::Bintree | A BinTree (or "Binary Interval Tree") is a 1-dimensional version of a quadtree |
►Cgeos::index::strtree::Boundable | A spatial object in an AbstractSTRtree |
Cgeos::index::strtree::AbstractNode | A node of the STR tree |
►Cgeos::index::strtree::ItemBoundable | Boundable wrapper for a non-Boundable spatial object. Used internally by AbstractSTRtree |
Cgeos::index::strtree::SimpleSTRnode | A node of the STR tree |
Cgeos::index::strtree::BoundablePair | A pair of Boundables, whose leaf items support a distance metric between them |
Cgeos::algorithm::BoundaryNodeRule | An interface for rules which determine whether node points which are in boundaries of lineal geometry components are in the boundary of the parent geometry collection |
Cgeos::operation::BoundaryOp | |
Cgeos::operation::buffer::BufferBuilder | Builds the buffer geometry for a given input geometry and precision model |
Cgeos::operation::buffer::BufferCurveSetBuilder | Creates all the raw offset curves for a buffer of a Geometry |
Cgeos::operation::buffer::BufferInputLineSimplifier | Simplifies a buffer input line to remove concavities with shallow depth |
Cgeos::operation::buffer::BufferOp | Computes the buffer of a geometry, for both positive and negative buffer distances |
Cgeos::operation::buffer::BufferParameters | Contains the parameters which describe how a buffer should be constructed |
Cgeos::operation::buffer::BufferSubgraph | A connected subset of the graph of DirectedEdge and geomgraph::Node |
Cgeos::operation::polygonize::BuildArea | Creates an areal geometry formed by the constituent linework of given geometry |
Cgeos::io::ByteOrderDataInStream | Allows reading an stream of primitive datatypes from an underlying istream, with the representation being in either common byte ordering |
Cgeos::io::ByteOrderValues | Methods to read and write primitive datatypes from/to byte sequences, allowing the byte order to be specified |
Cgeos::operation::geounion::CascadedPolygonUnion | Provides an efficient method of unioning a collection of polygonal geometries |
Cgeos::algorithm::CentralEndpointIntersector | Computes an approximate intersection of two line segments by taking the most central of the endpoints of the segments |
Cgeos::algorithm::Centroid | Computes the centroid of a Geometry of any dimension |
Cgeos::algorithm::CGAlgorithmsDD | Implements basic computational geometry algorithms using extended precision float-point arithmetic |
Cgeos::geom::CircularArc | |
Cgeos::precision::CommonBits | Determines the maximum number of common most-significant bits in the mantissa of one or numbers |
Cgeos::precision::CommonBitsOp | Provides versions of Geometry spatial functions which use common bit removal to reduce the likelihood of robustness problems |
Cgeos::precision::CommonBitsRemover | Allow computing and removing common mantissa bits from one or more Geometries |
Cgeos::algorithm::hull::ConcaveHull | |
Cgeos::algorithm::hull::ConcaveHullOfPolygons | |
Cgeos::planargraph::algorithm::ConnectedSubgraphFinder | Finds all connected Subgraph s of a PlanarGraph |
Cgeos::operation::valid::ConsistentAreaTester | Checks that a geomgraph::GeometryGraph representing an area (a geom::Polygon or geom::MultiPolygon) has consistent semantics for area geometries. This check is required for any reasonable polygonal model (including the OGC-SFS model, as well as models which allow ring self-intersection at single points) |
Cgeos::triangulate::polygon::ConstrainedDelaunayTriangulator | |
Cgeos::algorithm::ConvexHull | Computes the convex hull of a Geometry |
Cgeos::geom::Coordinate | Coordinate is the lightweight class used to store coordinates |
►Cgeos::geom::CoordinateFilter | Geometry classes support the concept of applying a coordinate filter to every coordinate in the Geometry |
Cgeos::operation::overlayng::PrecisionUtil::InherentScaleFilter | |
Cgeos::geom::CoordinateLessThan | Strict weak ordering Functor for Coordinate |
Cgeos::geom::CoordinateList | A list of Coordinate s, which may be set to prevent repeated coordinates from occurring in the list |
Cgeos::geom::CoordinateSequence | The internal representation of a list of coordinates inside a Geometry |
Cgeos::geom::CoordinateSequenceFilter | Interface for classes which provide operations that can be applied to the coordinates in a CoordinateSequence |
Cgeos::geom::CoordinateSequences | Utility methods to operate on CoordinateSequences. Methods that do not benefit from access to the CoordinateSequence internals can be placed here |
Cgeos::coverage::CoverageEdge | |
Cgeos::coverage::CoverageGapFinder | |
Cgeos::coverage::CoveragePolygonValidator | |
Cgeos::coverage::CoverageRingEdges | |
Cgeos::coverage::CoverageSimplifier | |
Cgeos::coverage::CoverageUnion | |
Cgeos::operation::overlayng::CoverageUnion | |
Cgeos::coverage::CoverageValidator | |
Cgeos::math::DD | Wrapper for DoubleDouble higher precision mathematics operations |
Cgeos::triangulate::DelaunayTriangulationBuilder | A utility class which creates Delaunay Triangulations from collections of points and extract the resulting triangulation edges or triangles as geometries |
Cgeos::geom::util::Densifier | |
Cgeos::geomgraph::Depth | A Depth object records the topological depth of the sides of an Edge for up to two Geometries |
Cgeos::geom::Dimension | |
Cgeos::planargraph::DirectedEdgeStar | A sorted collection of DirectedEdge which leave a Node in a PlanarGraph |
Cgeos::algorithm::distance::DiscreteFrechetDistance | An algorithm for computing a distance metric which is an approximation to the Frechet Distance based on a discretization of the input geom::Geometry |
Cgeos::algorithm::distance::DiscreteHausdorffDistance | An algorithm for computing a distance metric which is an approximation to the Hausdorff Distance based on a discretization of the input geom::Geometry |
Cgeos::algorithm::Distance | Functions to compute distance between basic geometric structures |
Cgeos::operation::distance::DistanceOp | Find two points on two geom::Geometry s which lie within a given distance, or else are the nearest points on the geometries (in which case this also provides the distance between the geometries) |
Cgeos::algorithm::distance::DistanceToPoint | |
Cgeos::simplify::DouglasPeuckerLineSimplifier | Simplifies a linestring (sequence of points) using the standard Douglas-Peucker algorithm |
Cgeos::simplify::DouglasPeuckerSimplifier | Simplifies a Geometry using the standard Douglas-Peucker algorithm |
Cgeos::operation::overlayng::Edge | |
►Cgeos::geomgraph::EdgeEnd | Models the end of an edge incident on a node |
Cgeos::geomgraph::DirectedEdge | A directed EdgeEnd |
Cgeos::operation::relate::EdgeEndBundle | A collection of geomgraph::EdgeEnd objects which originate at the same point and have the same direction |
Cgeos::operation::relate::EdgeEndBuilder | Computes the geomgraph::EdgeEnd objects which arise from a noded geomgraph::Edge |
►Cgeos::geomgraph::EdgeEndStar | A EdgeEndStar is an ordered list of EdgeEnds around a node |
Cgeos::geomgraph::DirectedEdgeStar | A DirectedEdgeStar is an ordered list of outgoing DirectedEdges around a node |
Cgeos::operation::relate::EdgeEndBundleStar | An ordered list of EdgeEndBundle objects around a RelateNode |
Cgeos::edgegraph::EdgeGraph | |
Cgeos::edgegraph::EdgeGraphBuilder | |
Cgeos::geomgraph::EdgeIntersection | Represents a point on an edge which intersects with another edge |
Cgeos::geomgraph::EdgeIntersectionList | A list of edge intersections along an Edge |
Cgeos::operation::overlayng::EdgeKey | |
Cgeos::geomgraph::EdgeList | A EdgeList is a list of Edges |
Cgeos::operation::overlayng::EdgeMerger | |
Cgeos::operation::overlayng::EdgeNodingBuilder | |
Cgeos::geomgraph::EdgeNodingValidator | Validates that a collection of SegmentStrings is correctly noded |
►Cgeos::geomgraph::EdgeRing | |
Cgeos::operation::overlay::MaximalEdgeRing | A ring of DirectedEdges which may contain nodes of degree > 2 |
Cgeos::operation::overlay::MinimalEdgeRing | A ring of Edges with the property that no node has degree greater than 2 |
Cgeos::operation::polygonize::EdgeRing | Represents a ring of PolygonizeDirectedEdge which form a ring of a polygon. The ring may be either an outer shell or a hole |
►Cgeos::geomgraph::index::EdgeSetIntersector | An EdgeSetIntersector computes all the intersections between the edges in the set |
Cgeos::geomgraph::index::SimpleEdgeSetIntersector | Finds all intersections in one or two sets of edges, using the straightforward method of comparing all segments |
Cgeos::geomgraph::index::SimpleMCSweepLineIntersector | Finds all intersections in one or two sets of edges, using an x-axis sweepline algorithm in conjunction with Monotone Chains |
Cgeos::geomgraph::index::SimpleSweepLineIntersector | Finds all intersections in one or two sets of edges, using a simple x-axis sweepline algorithm |
Cgeos::operation::overlayng::EdgeSourceInfo | |
Cgeos::operation::linemerge::EdgeString | A sequence of LineMergeDirectedEdge forming one of the lines that will be output by the line-merging process |
Cgeos::operation::overlayng::ElevationModel | A simple elevation model used to populate missing Z values in overlay results |
Cgeos::precision::EnhancedPrecisionOp | Provides versions of Geometry spatial functions which use enhanced precision techniques to reduce the likelihood of robustness problems |
Cgeos::geom::Envelope | An Envelope defines a rectangulare region of the 2D coordinate plane |
Cgeos::linearref::ExtractLineByLocation | Extracts the subline of a linear Geometry between two LinearLocation s on the line |
Cgeos::noding::FastNodingValidator | Validates that a collection of SegmentString s is correctly noded |
Cgeos::noding::FastSegmentSetIntersectionFinder | Finds if two sets of SegmentStrings intersect |
Cgeos::operation::overlay::validate::FuzzyPointLocator | Finds the most likely Location of a point relative to the polygonal components of a geometry, using a tolerance value |
Cgeos::io::GeoJSONReader | GeoJSON reader class; see also GeoJSONWriter |
Cgeos::io::GeoJSONWriter | Outputs the GeoJSON representation of a Geometry. See also GeoJSONReader for parsing |
►Cgeos::util::GeometricShapeFactory | Computes various kinds of common geometric shapes |
Cgeos::geom::util::SineStarFactory | |
►Cgeos::geom::Geometry | Basic implementation of Geometry, constructed and destructed by GeometryFactory |
►Cgeos::geom::GeometryCollection | Represents a collection of heterogeneous Geometry objects |
Cgeos::geom::MultiLineString | Models a collection of LineStrings |
Cgeos::geom::MultiPoint | |
Cgeos::geom::MultiPolygon | |
Cgeos::geom::Point | |
Cgeos::geom::Surface | |
Cgeos::geom::util::GeometryCombiner | Combines Geometrys to produce a GeometryCollection of the most appropriate type |
►Cgeos::geom::GeometryComponentFilter | |
Cgeos::geom::util::ComponentCoordinateExtracter | Extracts a single representative Coordinate from each connected component of a Geometry |
Cgeos::geom::util::LinearComponentExtracter | |
Cgeos::geom::util::GeometryEditor | |
►Cgeos::geom::util::GeometryEditorOperation | |
Cgeos::geom::util::CoordinateOperation | |
Cgeos::geom::util::GeometryExtracter | |
Cgeos::geom::GeometryFactory | Supplies a set of utility methods for building Geometry objects from CoordinateSequence or other Geometry objects |
►Cgeos::geom::GeometryFilter | Geometry classes support the concept of applying a Geometry filter to the Geometry |
Cgeos::geom::util::PointExtracter | |
Cgeos::geom::util::PolygonExtracter | |
Cgeos::operation::distance::ConnectedElementLocationFilter | A ConnectedElementPointFilter extracts a single point from each connected element in a Geometry (e.g. a polygon, linestring or point) and returns them in a list. Empty geometries do not provide a location item |
Cgeos::operation::distance::ConnectedElementPointFilter | Extracts a single point from each connected element in a Geometry (e.g. a polygon, linestring or point) and returns them in a list |
Cgeos::geom::util::GeometryFixer | |
►Cgeos::operation::GeometryGraphOperation | The base class for operations that require GeometryGraph |
Cgeos::operation::relate::RelateOp | Implements the SFS relate() operation on two geom::Geometry objects |
Cgeos::geom::util::GeometryLister | |
Cgeos::operation::distance::GeometryLocation | Represents the location of a point on a Geometry |
Cgeos::geom::util::GeometryMapper | |
Cgeos::precision::GeometryPrecisionReducer | Reduces the precision of a geom::Geometry according to the supplied geom::PrecisionModel , ensuring that the result is valid (unless specified otherwise) |
Cgeos::operation::overlay::snap::GeometrySnapper | Snaps the vertices and segments of a geom::Geometry to another Geometry's vertices |
►Cgeos::geom::util::GeometryTransformer | A framework for processes which transform an input Geometry into an output Geometry, possibly changing its structure and type(s) |
Cgeos::precision::PointwisePrecisionReducerTransformer | |
Cgeos::precision::PrecisionReducerTransformer | Reduces the precision of a geom::Geometry according to the supplied geom::PrecisionModel , without attempting to preserve valid topology |
►Cgeos::util::GEOSException | Base class for all GEOS exceptions |
Cgeos::algorithm::NotRepresentableException | Indicates that a HCoordinate has been computed which is not representable on the Cartesian plane |
Cgeos::io::ParseException | Notifies a parsing error |
Cgeos::util::AssertionFailedException | Indicates a bug in GEOS code |
Cgeos::util::IllegalArgumentException | Indicates one or more illegal arguments |
Cgeos::util::IllegalStateException | Indicates an illegal state |
Cgeos::util::TopologyException | Indicates an invalid or inconsistent topological situation encountered during processing |
Cgeos::util::UnsupportedOperationException | Indicates that the requested operation is unsupported |
►Cgeos::geomgraph::GraphComponent | A GraphComponent is the parent class for the objects' that form a graph |
Cgeos::geomgraph::Edge | |
►Cgeos::geomgraph::Node | The node component of a geometry graph |
Cgeos::operation::relate::RelateNode | Represents a node in the topological graph used to compute spatial relationships |
►Cgeos::planargraph::GraphComponent | The base class for all graph component classes |
►Cgeos::planargraph::DirectedEdge | Represents a directed edge in a PlanarGraph |
Cgeos::operation::linemerge::LineMergeDirectedEdge | A DirectedEdge of a LineMergeGraph |
Cgeos::operation::polygonize::PolygonizeDirectedEdge | A DirectedEdge of a PolygonizeGraph, which represents an edge of a polygon formed by the graph |
►Cgeos::planargraph::Edge | Represents an undirected edge of a PlanarGraph |
Cgeos::operation::linemerge::LineMergeEdge | An edge of a LineMergeGraph. The marked field indicates whether this Edge has been logically deleted from the graph |
Cgeos::operation::polygonize::PolygonizeEdge | An edge of a polygonization graph |
Cgeos::planargraph::Node | A node in a PlanarGraph is a location where 0 or more Edge meet |
►Cgeos::edgegraph::HalfEdge | |
Cgeos::operation::overlayng::OverlayEdge | |
Cgeos::algorithm::HCoordinate | Represents a homogeneous coordinate in a 2-D coordinate space |
Cgeos::shape::fractal::HilbertCode | |
Cgeos::operation::polygonize::HoleAssigner | Assigns hole rings to shell rings during polygonization |
Cgeos::noding::snapround::HotPixel | Implements a "hot pixel" as used in the Snap Rounding algorithm |
Cgeos::triangulate::IncrementalDelaunayTriangulator | Computes a Delauanay Triangulation of a set of quadedge::Vertex es, using an incrementatal insertion algorithm |
Cgeos::algorithm::construct::IndexedDistanceToPoint | Computes the distance between a point and a geometry (which may be a collection containing any type of geometry) |
Cgeos::operation::distance::IndexedFacetDistance | Computes the distance between the facets (segments and vertices) of two Geometrys using a Branch-and-Bound algorithm |
Cgeos::algorithm::construct::IndexedPointInPolygonsLocator | Determines the location of a point in the polygonal elements of a geometry |
Cgeos::operation::overlayng::InputGeometry | |
Cgeos::algorithm::InteriorPointArea | Computes a point in the interior of an areal geometry. The point will lie in the geometry interior in all except certain pathological cases |
Cgeos::algorithm::InteriorPointLine | Computes a point in the interior of an linear geometry |
Cgeos::algorithm::InteriorPointPoint | Computes a point in the interior of an point geometry |
Cgeos::util::Interrupt | Used to manage interruption requests and callbacks |
Cgeos::algorithm::Intersection | Functions to compute intersection points between lines and line segments |
Cgeos::geom::IntersectionMatrix | Implementation of Dimensionally Extended Nine-Intersection Model (DE-9IM) matrix |
Cgeos::operation::overlayng::IntersectionPointBuilder | |
Cgeos::index::strtree::AbstractSTRtree::IntersectsOp | A test for intersection between two bounds, necessary because subclasses of AbstractSTRtree have different implementations of bounds |
Cgeos::index::bintree::Interval | Represents an (1-dimensional) closed interval on the Real number line |
Cgeos::index::strtree::Interval | A contiguous portion of 1D-space. Used internally by SIRtree |
Cgeos::index::quadtree::IntervalSize | Provides a test for whether an interval is so small it should be considered as zero for the purposes of inserting it into a binary tree |
Cgeos::operation::valid::IsSimpleOp | |
Cgeos::operation::valid::IsValidOp | |
Cgeos::index::strtree::ItemDistance | A function method which computes the distance between two ItemBoundables in an STRtree. Used for Nearest Neighbour searches |
Cgeos::index::ItemVisitor | A visitor for items in an index |
Cgeos::index::kdtree::KdNode | |
Cgeos::index::kdtree::KdTree | |
Cgeos::index::bintree::Key | A Key is a unique identifier for a node in a tree |
Cgeos::index::quadtree::Key | A Key is a unique identifier for a node in a quadtree |
Cgeos::geomgraph::Label | A Label indicates the topological relationship of a component of a topology graph to a given Geometry |
Cgeos::algorithm::construct::LargestEmptyCircle | |
Cgeos::algorithm::Length | Functions for computing length |
Cgeos::linearref::LengthIndexedLine | Supports linear referencing along a linear geom::Geometry using the length along the line as the index |
Cgeos::linearref::LengthIndexOfPoint | Computes the length index of the point on a linear Geometry nearest a given Coordinate |
Cgeos::linearref::LengthLocationMap | Computes the LinearLocation for a given length along a linear Geometry |
Cgeos::linearref::LinearGeometryBuilder | Builds a linear geometry (LineString or MultiLineString) incrementally (point-by-point) |
Cgeos::linearref::LinearIterator | An iterator over the components and coordinates of a linear geometry (LineString or MultiLineString) |
Cgeos::linearref::LinearLocation | Represents a location along a LineString or MultiLineString |
Cgeos::operation::overlayng::LineBuilder | |
Cgeos::algorithm::LineIntersector | A LineIntersector is an algorithm that can both test whether two line segments intersect and compute the intersection point if they do |
Cgeos::operation::overlayng::LineLimiter | |
Cgeos::operation::linemerge::LineMerger | Sews together a set of fully noded LineStrings |
►Cgeos::geom::LineSegment | |
Cgeos::simplify::TaggedLineSegment | A geom::LineSegment which is tagged with its location in a geom::Geometry |
Cgeos::operation::linemerge::LineSequencer | Builds a sequence from a set of LineStrings so that they are ordered end to end |
Cgeos::operation::overlay::snap::LineStringSnapper | Snaps the vertices and segments of a LineString to a set of target snap vertices |
Cgeos::linearref::LocationIndexedLine | Supports linear referencing along a linear Geometry using LinearLocations as the index |
Cgeos::linearref::LocationIndexOfLine | Determines the location of a subline along a linear Geometry |
Cgeos::linearref::LocationIndexOfPoint | Computes the LinearLocation of the point on a linear Geometry nearest a given Coordinate |
Cgeos::operation::valid::MakeValid | The function attempts to create a valid representation of a given invalid geometry without losing any of the input vertices |
Cgeos::algorithm::construct::MaximumInscribedCircle | |
Cgeos::noding::snapround::MCIndexPointSnapper | "Snaps" all SegmentStrings in a SpatialIndex containing MonotoneChains to a given HotPixel |
Cgeos::algorithm::MinimumAreaRectangle | |
Cgeos::precision::MinimumClearance | Computes the Minimum Clearance of a Geometry |
Cgeos::algorithm::MinimumDiameter | Computes the minimum diameter of a geom::Geometry |
Cgeos::geomgraph::index::MonotoneChain | |
Cgeos::index::chain::MonotoneChain | Monotone Chains are a way of partitioning the segments of a linestring to allow for fast searching of intersections |
Cgeos::index::chain::MonotoneChainBuilder | Constructs MonotoneChains for sequences of Coordinates |
Cgeos::geomgraph::index::MonotoneChainEdge | MonotoneChains are a way of partitioning the segments of an edge to allow for fast searching of intersections |
Cgeos::geomgraph::index::MonotoneChainIndexer | MonotoneChains are a way of partitioning the segments of an edge to allow for fast searching of intersections |
►Cgeos::index::chain::MonotoneChainOverlapAction | The action for the internal iterator for performing overlap queries on a MonotoneChain |
Cgeos::operation::relateng::EdgeSegmentOverlapAction | The action for the internal iterator for performing overlap queries on a MonotoneChain |
Cgeos::index::chain::MonotoneChainSelectAction | |
Cgeos::shape::fractal::MortonCode | |
►Cgeos::index::bintree::NodeBase | The base class for nodes in a Bintree |
Cgeos::index::bintree::Node | A node of a Bintree |
Cgeos::index::bintree::Root | The root node of a single Bintree |
►Cgeos::index::quadtree::NodeBase | The base class for nodes in a Quadtree |
Cgeos::index::quadtree::Node | Represents a node of a Quadtree |
Cgeos::index::quadtree::Root | QuadRoot is the root of a single Quadtree. It is centred at the origin, and does not have a defined extent |
Cgeos::planargraph::NodeMap | A map of Node, indexed by the coordinate of the node |
►Cgeos::noding::Noder | Computes all intersections between segments in a set of SegmentString |
Cgeos::noding::BoundaryChainNoder | |
Cgeos::noding::IteratedNoder | Nodes a set of SegmentStrings completely |
Cgeos::noding::ScaledNoder | Wraps a Noder and transforms its input into the integer domain |
Cgeos::noding::SegmentExtractingNoder | |
►Cgeos::noding::SinglePassNoder | Base class for Noder s which make a single pass to find intersections |
Cgeos::noding::MCIndexNoder | Nodes a set of SegmentString using a index based on MonotoneChain and a SpatialIndex |
Cgeos::noding::SimpleNoder | Nodes a set of SegmentString s by performing a brute-force comparison of every segment to every other one |
Cgeos::noding::ValidatingNoder | |
Cgeos::noding::snap::SnappingNoder | |
Cgeos::noding::snapround::MCIndexSnapRounder | Uses Snap Rounding to compute a rounded, fully noded arrangement from a set of SegmentString |
Cgeos::noding::snapround::SnapRoundingNoder | |
Cgeos::operation::relateng::NodeSection | |
Cgeos::noding::NodingValidator | Validates that a collection of SegmentString s is correctly noded. Throws a TopologyException if a noding error is found |
Cgeos::noding::Octant | Methods for computing and working with octants of the Cartesian plane |
Cgeos::operation::buffer::OffsetCurve | |
Cgeos::operation::buffer::OffsetCurveBuilder | Computes the raw offset curve for a single Geometry component (ring, line or point) |
Cgeos::operation::buffer::OffsetCurveSection | |
Cgeos::operation::overlay::validate::OffsetPointGenerator | Generates points offset from both sides of all segments in a geometry |
Cgeos::operation::buffer::OffsetSegmentGenerator | |
Cgeos::operation::buffer::OffsetSegmentString | |
Cgeos::io::OrdinateSet | Utility class to manipulate a set of flags indicating whether X, Y, Z, or M dimensions are present. Based on JTS EnumSet<Ordinate> |
Cgeos::algorithm::Orientation | Functions to compute the orientation of basic geometric structures including point triplets (triangles) and rings |
Cgeos::noding::OrientedCoordinateArray | Allows comparing geom::CoordinateSequence s in an orientation-independent way |
Cgeos::algorithm::hull::OuterShellsExtracter | |
Cgeos::operation::geounion::OverlapUnion | Unions MultiPolygons efficiently by using full topological union only for polygons which may overlap by virtue of intersecting the common area of the inputs |
Cgeos::operation::overlayng::OverlayGraph | |
Cgeos::operation::overlayng::OverlayLabel | |
Cgeos::operation::overlayng::OverlayMixedPoints | |
Cgeos::operation::overlayng::OverlayNG | |
Cgeos::operation::overlayng::OverlayNGRobust | |
Cgeos::operation::overlay::OverlayNodeFactory | Creates nodes for use in the geomgraph::PlanarGraph constructed during overlay operations. NOTE: also used by operation::valid |
Cgeos::operation::overlayng::OverlayPoints | |
Cgeos::operation::overlay::validate::OverlayResultValidator | Validates that the result of an overlay operation is geometrically correct within a determined tolerance |
Cgeos::operation::overlayng::OverlayUtil | |
►Cgeos::geomgraph::PlanarGraph | Represents a directed graph which is embeddable in a planar surface |
Cgeos::geomgraph::GeometryGraph | A GeometryGraph is a graph that models a given Geometry |
►Cgeos::planargraph::PlanarGraph | Represents a directed graph which is embeddable in a planar surface |
Cgeos::operation::linemerge::LineMergeGraph | A planar graph of edges that is analyzed to sew the edges together |
Cgeos::operation::polygonize::PolygonizeGraph | Represents a planar graph of edges that can be used to compute a polygonization, and implements the algorithms to compute the EdgeRings formed by the graph |
Cgeos::operation::geounion::PointGeometryUnion | Computes the union of a puntal geometry with another arbitrary Geometry |
Cgeos::algorithm::PointLocation | Functions for locating points within basic geometric structures such as lines and rings |
Cgeos::algorithm::PointLocator | Computes the topological relationship (Location) of a single point to a Geometry |
►Cgeos::algorithm::locate::PointOnGeometryLocator | An interface for classes which determine the Location of points in Polygon or MultiPolygon geometries |
Cgeos::algorithm::locate::IndexedPointInAreaLocator | Determines the location of Coordinates relative to an areal geometry, using indexing for efficiency |
Cgeos::algorithm::locate::SimplePointInAreaLocator | Computes the location of points relative to a polygonal Geometry, using a simple O(n) algorithm |
Cgeos::operation::overlayng::IndexedPointOnLineLocator | |
Cgeos::algorithm::distance::PointPairDistance | |
Cgeos::geom::util::PolygonalExtracter | Extracts the polygonal (Polygon and MultiPolygon) elements from a Geometry |
Cgeos::operation::overlay::PolygonBuilder | Forms Polygon out of a graph of geomgraph::DirectedEdge |
Cgeos::triangulate::polygon::PolygonEarClipper | |
Cgeos::triangulate::polygon::PolygonHoleJoiner | |
Cgeos::simplify::PolygonHullSimplifier | |
Cgeos::operation::polygonize::Polygonizer | Polygonizes a set of Geometrys which contain linework that represents the edges of a planar graph |
Cgeos::operation::relateng::PolygonNodeConverter | |
Cgeos::triangulate::polygon::PolygonNoder | |
Cgeos::algorithm::PolygonNodeTopology | |
Cgeos::triangulate::polygon::PolygonTriangulator | |
Cgeos::geom::Position | A Position indicates the position of a Location relative to a graph component (Node, Edge, or Area) |
Cgeos::geom::PrecisionModel | Specifies the precision model of the Coordinate in a Geometry |
Cgeos::operation::overlayng::PrecisionReducer | |
Cgeos::operation::overlayng::PrecisionUtil | |
►Cgeos::geom::prep::PreparedGeometry | An interface for classes which prepare Geometry s in order to optimize the performance of repeated calls to specific geometric operations |
►Cgeos::geom::prep::BasicPreparedGeometry | A base class for PreparedGeometry subclasses |
Cgeos::geom::prep::PreparedLineString | A prepared version of LinearRing , LineString or MultiLineString geometries |
Cgeos::geom::prep::PreparedPoint | A prepared version of Point or MultiPoint geometries |
Cgeos::geom::prep::PreparedPolygon | A prepared version of Polygon or MultiPolygon geometries |
Cgeos::geom::prep::PreparedGeometryFactory | A factory for creating PreparedGeometry s |
Cgeos::geom::prep::PreparedLineStringIntersects | Computes the intersects spatial relationship predicate for a target PreparedLineString relative to all other Geometry classes |
►Cgeos::geom::prep::PreparedPolygonPredicate | A base class for predicate operations on PreparedPolygon s |
►Cgeos::geom::prep::AbstractPreparedPolygonContains | A base class containing the logic for computes the contains and covers spatial relationship predicates for a PreparedPolygon relative to all other Geometry classes |
Cgeos::geom::prep::PreparedPolygonContains | Computes the contains spatial relationship predicate for a PreparedPolygon relative to all other Geometry classes |
Cgeos::geom::prep::PreparedPolygonCovers | Computes the covers spatial relationship predicate for a PreparedPolygon relative to all other Geometry classes |
Cgeos::geom::prep::PreparedPolygonContainsProperly | Computes the containsProperly spatial relationship predicate for PreparedPolygon s relative to all other Geometry classes |
Cgeos::geom::prep::PreparedPolygonIntersects | Computes the intersects spatial relationship predicate for PreparedPolygon s relative to all other Geometry classes |
Cgeos::triangulate::quadedge::QuadEdge | A class that represents the edge data structure which implements the quadedge algebra |
►Cgeos::triangulate::quadedge::QuadEdgeLocator | An interface for classes which locate an edge in a QuadEdgeSubdivision which either contains a given Vertex V or is an edge of a triangle which contains V |
Cgeos::triangulate::quadedge::LastFoundQuadEdgeLocator | Locates QuadEdge s in a QuadEdgeSubdivision , optimizing the search by starting in the locality of the last edge found |
Cgeos::triangulate::quadedge::QuadEdgeSubdivision | A class that contains the QuadEdges representing a planar subdivision that models a triangulation |
Cgeos::geom::Quadrant | Utility functions for working with quadrants |
Cgeos::algorithm::RayCrossingCounter | Counts the number of segments crossed by a horizontal ray extending to the right from a given point, in an incremental fashion |
Cgeos::operation::intersection::Rectangle | Clipping rectangle |
Cgeos::operation::predicate::RectangleContains | Optimized implementation of spatial predicate "contains" for cases where the first Geometry is a rectangle |
Cgeos::operation::intersection::RectangleIntersection | Speed-optimized clipping of a Geometry with a rectangle |
Cgeos::operation::intersection::RectangleIntersectionBuilder | Rebuild geometries from subpaths left by clipping with a rectangle |
Cgeos::operation::predicate::RectangleIntersects | Optimized implementation of the "intersects" spatial predicate for cases where one Geometry is a rectangle |
Cgeos::operation::relate::RelateComputer | Computes the topological relationship between two Geometries |
Cgeos::operation::relateng::RelateNG | |
Cgeos::operation::relate::RelateNodeFactory | Used by the geomgraph::NodeMap in a RelateNodeGraph to create RelateNode objects |
Cgeos::operation::relate::RelateNodeGraph | Implements the simple graph of Nodes and geomgraph::EdgeEnd which is all that is required to determine topological relationships between Geometries |
Cgeos::operation::relateng::RelatePointLocator | |
Cgeos::operation::valid::RepeatedPointRemover | |
Cgeos::operation::valid::RepeatedPointTester | Implements the appropriate checks for repeated points (consecutive identical coordinates) as defined in the JTS spec |
Cgeos::operation::buffer::RightmostEdgeFinder | A RightmostEdgeFinder find the geomgraph::DirectedEdge in a list which has the highest coordinate, and which is oriented L to R at that point. (I.e. the right side is on the RHS of the edge.) |
Cgeos::operation::overlayng::RingClipper | |
Cgeos::operation::overlayng::RobustClipEnvelopeComputer | |
Cgeos::algorithm::RobustDeterminant | Implements an algorithm to compute the sign of a 2x2 determinant for double precision values robustly |
Cgeos::operation::predicate::SegmentIntersectionTester | Tests if any line segments in two sets of CoordinateSequences intersect |
Cgeos::geomgraph::index::SegmentIntersector | Computes the intersection of line segments, and adds the intersection to the edges containing the segments |
►Cgeos::noding::SegmentIntersector | Processes possible intersections detected by a Noder |
Cgeos::coverage::InvalidSegmentDetector | |
Cgeos::noding::IntersectionAdder | Computes the intersections between two line segments in SegmentString and adds them to each string |
Cgeos::noding::IntersectionFinderAdder | Finds proper and interior intersections in a set of SegmentStrings, and adds them as nodes |
Cgeos::noding::NodingIntersectionFinder | Finds non-noded intersections in a set of SegmentString s, if any exist |
Cgeos::noding::SegmentIntersectionDetector | Detects and records an intersection between two SegmentString s, if one exists |
Cgeos::noding::snapround::SnapRoundingIntersectionAdder | |
Cgeos::noding::SegmentNode | Represents an intersection point between two NodedSegmentString |
Cgeos::noding::SegmentNodeList | A list of the SegmentNode present along a NodedSegmentString |
Cgeos::noding::SegmentPointComparator | Implements a robust method of comparing the relative position of two points along the same segment |
►Cgeos::noding::SegmentSetMutualIntersector | An intersector for the red-blue intersection problem |
Cgeos::noding::MCIndexSegmentSetMutualIntersector | Intersects two sets of SegmentStrings using a index based on MonotoneChains and a SpatialIndex |
►Cgeos::noding::SegmentString | An interface for classes which represent a sequence of contiguous line segments |
Cgeos::noding::BasicSegmentString | Represents a list of contiguous line segments, and supports noding the segments |
►Cgeos::noding::NodableSegmentString | An interface for classes which support adding nodes to a segment string |
Cgeos::noding::NodedSegmentString | Represents a list of contiguous line segments, and supports noding the segments |
Cgeos::noding::SegmentStringUtil | Utility methods for processing SegmentString s |
Cgeos::operation::sharedpaths::SharedPathsOp | Find shared paths among two linear Geometry objects |
Cgeos::geom::util::ShortCircuitedGeometryVisitor | A visitor to Geometry elements which can be short-circuited by a given condition |
Cgeos::precision::SimpleGeometryPrecisionReducer | Reduces the precision of a geom::Geometry according to the supplied geom::PrecisionModel , without attempting to preserve valid topology |
Cgeos::operation::overlay::snap::SnapOverlayOp | Performs an overlay operation using snapping and enhanced precision to improve the robustness of the result |
Cgeos::index::intervalrtree::SortedPackedIntervalRTree | A static index on a set of 1-dimensional intervals, using an R-Tree packed based on the order of the interval midpoints |
►Cgeos::index::SpatialIndex | Abstract class defines basic insertion and query operations supported by classes implementing spatial index algorithms |
Cgeos::index::quadtree::Quadtree | A Quadtree is a spatial index structure for efficient querying of 2D rectangles. If other kinds of spatial objects need to be indexed they can be represented by their envelopes |
Cgeos::index::strtree::STRtree | A query-only R-tree created using the Sort-Tile-Recursive (STR) algorithm. For two-dimensional spatial data |
Cgeos::index::strtree::SimpleSTRtree | A query-only R-tree created using the Sort-Tile-Recursive (STR) algorithm. For two-dimensional spatial data |
Cgeos::planargraph::Subgraph | A subgraph of a PlanarGraph |
Cgeos::operation::buffer::SubgraphDepthLocater | Locates a subgraph inside a set of subgraphs, in order to determine the outside depth of the subgraph |
Cgeos::index::sweepline::SweepLineIndex | A sweepline implements a sorted index on a set of intervals |
Cgeos::simplify::TaggedLinesSimplifier | Simplifies a collection of TaggedLineStrings, preserving topology (in the sense that no new intersections are introduced) |
Cgeos::simplify::TaggedLineString | Contains and owns a list of TaggedLineSegments |
Cgeos::simplify::TaggedLineStringSimplifier | Simplifies a TaggedLineString, preserving topology (in the sense that no new intersections are introduced). Uses the recursive Douglas-Peucker algorithm |
Cgeos::index::strtree::TemplateSTRtreeImpl< ItemType, BoundsTraits > | A query-only R-tree created using the Sort-Tile-Recursive (STR) algorithm. For one- or two-dimensional spatial data |
Cgeos::index::strtree::TemplateSTRtreeImpl< const FacetSequence *, EnvelopeTraits > | |
Cgeos::index::strtree::TemplateSTRtreeImpl< const geos::geom::LinearRing *, EnvelopeTraits > | |
Cgeos::index::strtree::TemplateSTRtreeImpl< const geos::index::chain::MonotoneChain *, EnvelopeTraits > | |
Cgeos::index::strtree::TemplateSTRtreeImpl< geos::operation::polygonize::EdgeRing *, EnvelopeTraits > | |
Cgeos::index::strtree::TemplateSTRtreeImpl< ItemType *, EnvelopeTraits > | |
Cgeos::index::strtree::TemplateSTRtreeImpl< ItemType, EnvelopeTraits > | |
Cgeos::index::strtree::TemplateSTRtreeImpl< SegmentView, index::strtree::IntervalTraits > | |
Cgeos::geomgraph::TopologyLocation | A TopologyLocation is the labelling of a GraphComponent's topological relationship to a single Geometry |
Cgeos::simplify::TopologyPreservingSimplifier | Simplifies a geometry, ensuring that the result is a valid geometry having the same dimension and number of components as the input |
Cgeos::operation::valid::TopologyValidationError | Contains information about the nature and location of a geom::Geometry validation error |
Cgeos::coverage::TPVWSimplifier | |
Cgeos::triangulate::tri::Tri | |
Cgeos::geom::Triangle | Represents a planar triangle, and provides methods for calculating various properties of triangles |
Cgeos::triangulate::quadedge::TrianglePredicate | Algorithms for computing values and predicates associated with triangles |
Cgeos::triangulate::quadedge::TriangleVisitor | An interface for algorithms which process the triangles in a QuadEdgeSubdivision |
Cgeos::triangulate::tri::TriangulationBuilder | |
Cgeos::triangulate::polygon::TriDelaunayImprover | |
Cgeos::triangulate::tri::TriEdge | |
Cgeos::triangulate::tri::TriList< TriType > | |
Cgeos::triangulate::tri::TriList< geos::triangulate::tri::Tri > | |
Cgeos::triangulate::tri::TriList< HullTri > | |
Cgeos::operation::overlayng::UnaryUnionNG | |
Cgeos::operation::geounion::UnaryUnionOp | Unions a collection of Geometry or a single Geometry (which may be a collection) together |
Cgeos::operation::cluster::UnionFind | |
►Cgeos::operation::geounion::UnionStrategy | |
Cgeos::operation::geounion::ClassicUnionStrategy | Implementation of UnionStrategy that provides overlay using the first generation overlay routines |
Cgeos::operation::overlayng::UnaryUnionNG::NGUnionStrategy | |
Cgeos::triangulate::quadedge::Vertex | Models a site (node) in a QuadEdgeSubdivision |
Cgeos::index::VertexSequencePackedRtree | |
Cgeos::triangulate::VoronoiDiagramBuilder | A utility class which creates Voronoi Diagrams from collections of points |
Cgeos::io::WKBReader | Reads a Geometry from Well-Known Binary format |
Cgeos::io::WKBWriter | Writes a Geometry into Well-Known Binary format |
Cgeos::io::WKTReader | WKT parser class; see also WKTWriter |
Cgeos::io::WKTWriter | Outputs the textual representation of a Geometry. See also WKTReader |