GEOS  3.9.1dev
Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 123]
 Cgeos::detail::_Unique_if< T >
 Cgeos::detail::_Unique_if< T[]>
 Cgeos::detail::_Unique_if< T[N]>
 Cgeos::index::strtree::AbstractSTRtreeBase class for STRtree and SIRtree
 Cgeos::algorithm::AngleUtility functions for working with angles
 Cgeos::algorithm::Area
 Cgeos::util::Assert
 Cgeos::index::bintree::BintreeA BinTree (or "Binary Interval Tree") is a 1-dimensional version of a quadtree
 Cgeos::index::strtree::BoundableA spatial object in an AbstractSTRtree
 Cgeos::index::strtree::BoundablePairA pair of Boundables, whose leaf items support a distance metric between them
 Cgeos::index::strtree::BoundablePair::BoundablePairQueueCompare
 Cgeos::algorithm::BoundaryNodeRuleAn 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::buffer::BufferBuilderBuilds the buffer geometry for a given input geometry and precision model
 Cgeos::operation::buffer::BufferInputLineSimplifierSimplifies a buffer input line to remove concavities with shallow depth
 Cgeos::operation::buffer::BufferOpComputes the buffer of a geometry, for both positive and negative buffer distances
 Cgeos::operation::buffer::BufferParametersContains the parameters which describe how a buffer should be constructed
 Cgeos::operation::buffer::BufferSubgraphA connected subset of the graph of DirectedEdge and geomgraph::Node
 Cgeos::operation::polygonize::BuildAreaCreates an areal geometry formed by the constituent linework of given geometry
 Cgeos::io::ByteOrderDataInStreamAllows reading an stream of primitive datatypes from an underlying istream, with the representation being in either common byte ordering
 Cgeos::io::ByteOrderValuesMethods to read and write primitive datatypes from/to byte sequences, allowing the byte order to be specified
 Cgeos::operation::geounion::CascadedPolygonUnionProvides an efficient method of unioning a collection of polygonal geometries
 Cgeos::operation::geounion::CascadedUnionProvides an efficient method of unioning a collection of Geometries
 Cgeos::algorithm::construct::LargestEmptyCircle::Cell
 Cgeos::algorithm::construct::MaximumInscribedCircle::Cell
 Cgeos::algorithm::CentralEndpointIntersectorComputes an approximate intersection of two line segments by taking the most central of the endpoints of the segments
 Cgeos::algorithm::CentroidComputes the centroid of a Geometry of any dimension
 Cgeos::algorithm::CGAlgorithmsDDImplements basic computational geometry algorithms using extended precision float-point arithmetic
 Cgeos::io::CLocalizer
 Cgeos::precision::CommonBitsDetermines the maximum number of common most-significant bits in the mantissa of one or numbers
 Cgeos::precision::CommonBitsOpProvides versions of Geometry spatial functions which use common bit removal to reduce the likelihood of robustness problems
 Cgeos::precision::CommonBitsRemoverAllow computing and removing common mantissa bits from one or more Geometries
 Cgeos::operation::valid::ConnectedInteriorTesterThis class tests that the interior of an area Geometry (Polygon or MultiPolygon) is connected
 Cgeos::planargraph::algorithm::ConnectedSubgraphFinderFinds all connected Subgraphs of a PlanarGraph
 Cgeos::operation::valid::ConsistentAreaTesterChecks 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::algorithm::ConvexHullComputes the convex hull of a Geometry
 Cgeos::geom::CoordinateCoordinate is the lightweight class used to store coordinates
 Cgeos::geom::CoordinateFilterGeometry classes support the concept of applying a coordinate filter to every coordinate in the Geometry
 Cgeos::geom::CoordinateLessThenStrict weak ordering Functor for Coordinate
 Cgeos::geom::CoordinateListA list of Coordinates, which may be set to prevent repeated coordinates from occuring in the list
 Cgeos::geom::CoordinateSequenceThe internal representation of a list of coordinates inside a Geometry
 Cgeos::geom::CoordinateSequenceFactoryA factory to create concrete instances of CoordinateSequences
 Cgeos::geom::CoordinateSequenceFilterInterface for classes which provide operations that can be applied to the coordinates in a CoordinateSequence
 Cgeos::operation::geounion::CoverageUnion
 Cgeos::math::DDWrapper for DoubleDouble higher precision mathematics operations
 Cgeos::triangulate::DelaunayTriangulationBuilderA 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::DepthA Depth object records the topological depth of the sides of an Edge for up to two Geometries
 Cgeos::geom::Dimension
 Cgeos::util::GeometricShapeFactory::Dimensions
 Cgeos::planargraph::DirectedEdgeStarA sorted collection of DirectedEdge which leave a Node in a PlanarGraph
 Cgeos::algorithm::distance::DiscreteFrechetDistanceAn 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::DiscreteHausdorffDistanceAn 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::DistanceFunctions to compute distance between basic geometric structures
 Cgeos::operation::distance::DistanceOpFind two points on two geom::Geometrys 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::DouglasPeuckerLineSimplifierSimplifies a linestring (sequence of points) using the standard Douglas-Peucker algorithm
 Cgeos::simplify::DouglasPeuckerSimplifierSimplifies a Geometry using the standard Douglas-Peucker algorithm
 Cgeos::operation::overlayng::Edge
 Cgeos::geomgraph::EdgeEndModels the end of an edge incident on a node
 Cgeos::operation::relate::EdgeEndBuilderComputes the geomgraph::EdgeEnd objects which arise from a noded geomgraph::Edge
 Cgeos::geomgraph::EdgeEndLT
 Cgeos::geomgraph::EdgeEndStarA EdgeEndStar is an ordered list of EdgeEnds around a node
 Cgeos::edgegraph::EdgeGraph
 Cgeos::edgegraph::EdgeGraphBuilder
 Cgeos::geomgraph::EdgeIntersectionRepresents a point on an edge which intersects with another edge
 Cgeos::geomgraph::EdgeIntersectionLessThen
 Cgeos::geomgraph::EdgeIntersectionListA list of edge intersections along an Edge
 Cgeos::operation::overlayng::EdgeKey
 Cgeos::geomgraph::EdgeListA EdgeList is a list of Edges
 Cgeos::operation::overlayng::EdgeMerger
 Cgeos::operation::overlayng::EdgeNodingBuilder
 Cgeos::geomgraph::EdgeNodingValidatorValidates that a collection of SegmentStrings is correctly noded
 Cgeos::geomgraph::EdgeRing
 Cgeos::operation::polygonize::EdgeRingRepresents 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::EdgeSetIntersectorAn EdgeSetIntersector computes all the intersections between the edges in the set
 Cgeos::operation::overlay::EdgeSetNoderNodes a set of edges
 Cgeos::operation::overlayng::EdgeSourceInfo
 Cgeos::operation::linemerge::EdgeStringA sequence of LineMergeDirectedEdge forming one of the lines that will be output by the line-merging process
 Cgeos::operation::overlayng::ElevationModel::ElevationCell
 Cgeos::operation::overlay::ElevationMatrix
 Cgeos::operation::overlay::ElevationMatrixCell
 Cgeos::operation::overlayng::ElevationModelA simple elevation model used to populate missing Z values in overlay results
 Cgeos::precision::EnhancedPrecisionOpProvides versions of Geometry spatial functions which use enhanced precision techniques to reduce the likelihood of robustness problems
 Cgeos::geom::EnvelopeAn Envelope defines a rectangulare region of the 2D coordinate plane
 Cgeos::index::strtree::EnvelopeUtil
 Cgeos::linearref::ExtractLineByLocationExtracts the subline of a linear Geometry between two LinearLocations on the line
 Cgeos::operation::distance::FacetSequence
 Cgeos::operation::distance::FacetSequenceTreeBuilder
 Cgeos::noding::FastNodingValidatorValidates that a collection of SegmentStrings is correctly noded
 Cgeos::operation::overlay::PolygonBuilder::FastPIPRing
 Cgeos::noding::FastSegmentSetIntersectionFinderFinds if two sets of SegmentStrings intersect
 Cgeos::operation::overlay::validate::FuzzyPointLocatorFinds the most likely Location of a point relative to the polygonal components of a geometry, using a tolerance value
 Cgeos::util::GeometricShapeFactoryComputes various kinds of common geometric shapes
 Cgeos::geom::GeometryBasic implementation of Geometry, constructed and destructed by GeometryFactory
 Cgeos::geom::util::GeometryCombinerCombines Geometrys to produce a GeometryCollection of the most appropriate type
 Cgeos::geom::GeometryComponentFilter
 Cgeos::geom::util::GeometryEditor
 Cgeos::geom::util::GeometryEditorOperation
 Cgeos::geom::util::GeometryExtracter
 Cgeos::geom::GeometryFactorySupplies a set of utility methods for building Geometry objects from CoordinateSequence or other Geometry objects
 Cgeos::geom::GeometryFactory::GeometryFactoryDeleter
 Cgeos::geom::GeometryFilterGeometry classes support the concept of applying a Geometry filter to the Geometry
 Cgeos::operation::GeometryGraphOperationThe base class for operations that require GeometryGraph
 Cgeos::geom::GeometryGreaterThen
 Cgeos::operation::distance::GeometryLocationRepresents the location of a point on a Geometry
 Cgeos::noding::GeometryNoder
 Cgeos::precision::GeometryPrecisionReducerReduces 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::GeometrySnapperSnaps the vertices and segments of a geom::Geometry to another Geometry's vertices
 Cgeos::geom::util::GeometryTransformerA framework for processes which transform an input Geometry into an output Geometry, possibly changing its structure and type(s)
 Cgeos::geom::GeomPtrPair
 Cgeos::geomgraph::GraphComponentA GraphComponent is the parent class for the objects' that form a graph
 Cgeos::planargraph::GraphComponentThe base class for all graph component classes
 Cgeos::edgegraph::HalfEdge
 Cgeos::geom::LineSegment::HashCode
 Cgeos::geom::Coordinate::HashCode
 Cgeos::noding::OrientedCoordinateArray::HashCode
 Cgeos::algorithm::HCoordinateRepresents a homogeneous coordinate in a 2-D coordinate space
 Cgeos::shape::fractal::HilbertCode
 Cgeos::shape::fractal::HilbertEncoder
 Cgeos::operation::polygonize::HoleAssignerAssigns hole rings to shell rings during polygonization
 Cgeos::noding::snapround::HotPixelImplements a "hot pixel" as used in the Snap Rounding algorithm
 Cgeos::noding::snapround::HotPixelIndex
 Cgeos::triangulate::IncrementalDelaunayTriangulatorComputes a Delauanay Triangulation of a set of quadedge::Vertexes, using an incrementatal insertion algorithm
 Cgeos::operation::distance::IndexedFacetDistanceComputes the distance between the facets (segments and vertices) of two Geometrys using a Branch-and-Bound algorithm
 Cgeos::operation::valid::IndexedNestedRingTesterTests whether any of a set of LinearRings are nested inside another ring in the set, using a spatial index to speed up the comparisons
 Cgeos::operation::valid::IndexedNestedShellTester
 Cgeos::operation::overlayng::InputGeometry
 Cgeos::algorithm::InteriorPointAreaComputes 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::InteriorPointLineComputes a point in the interior of an linear geometry
 Cgeos::algorithm::InteriorPointPointComputes a point in the interior of an point geometry
 Cgeos::util::InterruptUsed to manage interruption requests and callbacks
 Cgeos::algorithm::IntersectionComputes the intersection point of two lines. If the lines are parallel or collinear this case is detected and null is returned
 Cgeos::geom::IntersectionMatrixImplementation of Dimensionally Extended Nine-Intersection Model (DE-9IM) matrix
 Cgeos::operation::overlayng::IntersectionPointBuilder
 Cgeos::index::strtree::AbstractSTRtree::IntersectsOpA test for intersection between two bounds, necessary because subclasses of AbstractSTRtree have different implementations of bounds
 Cgeos::index::bintree::IntervalRepresents an (1-dimensional) closed interval on the Real number line
 Cgeos::index::strtree::IntervalA contiguous portion of 1D-space. Used internally by SIRtree
 Cgeos::algorithm::locate::IndexedPointInAreaLocator::IntervalIndexedGeometry
 Cgeos::index::intervalrtree::IntervalRTreeNode
 Cgeos::index::quadtree::IntervalSizeProvides 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::IsSimpleOpTests whether a Geometry is simple
 Cgeos::operation::valid::IsValidOpImplements the algorithsm required to compute the isValid() method for Geometrys
 Cgeos::index::strtree::ItemDistanceA function method which computes the distance between two ItemBoundables in an STRtree. Used for Nearest Neighbour searches
 Cgeos::index::strtree::ItemsListItem
 Cgeos::index::ItemVisitorA visitor for items in an index
 Cgeos::index::kdtree::KdNode
 Cgeos::index::kdtree::KdNodeVisitor
 Cgeos::index::kdtree::KdTree
 Cgeos::index::bintree::KeyA Key is a unique identifier for a node in a tree
 Cgeos::index::quadtree::KeyA Key is a unique identifier for a node in a quadtree
 Cgeos::geomgraph::LabelA Label indicates the topological relationship of a component of a topology graph to a given Geometry
 Cgeos::algorithm::construct::LargestEmptyCircle
 Cgeos::algorithm::LengthFunctions for computing length
 Cgeos::linearref::LengthIndexedLineSupports linear referencing along a linear geom::Geometry using the length along the line as the index
 Cgeos::linearref::LengthIndexOfPointComputes the length index of the point on a linear Geometry nearest a given Coordinate
 Cgeos::linearref::LengthLocationMapComputes the LinearLocation for a given length along a linear Geometry
 Cgeos::linearref::LinearGeometryBuilderBuilds a linear geometry (LineString or MultiLineString) incrementally (point-by-point)
 Cgeos::linearref::LinearIteratorAn iterator over the components and coordinates of a linear geometry (LineString or MultiLineString)
 Cgeos::linearref::LinearLocationRepresents a location along a LineString or MultiLineString
 Cgeos::operation::overlay::LineBuilderForms JTS LineStrings out of a the graph of geomgraph::DirectedEdge created by an OverlayOp
 Cgeos::operation::overlayng::LineBuilder
 Cgeos::algorithm::LineIntersectorA 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::LineMergerSews together a set of fully noded LineStrings
 Cgeos::geom::LineSegment
 Cgeos::simplify::LineSegmentIndex
 Cgeos::operation::linemerge::LineSequencerBuilds a sequence from a set of LineStrings so that they are ordered end to end
 Cgeos::geom::LineStringLT
 Cgeos::operation::overlay::snap::LineStringSnapperSnaps the vertices and segments of a LineString to a set of target snap vertices
 Cgeos::linearref::LocationIndexedLineSupports linear referencing along a linear Geometry using LinearLocations as the index
 Cgeos::linearref::LocationIndexOfLineDetermines the location of a subline along a linear Geometry
 Cgeos::linearref::LocationIndexOfPointComputes the LinearLocation of the point on a linear Geometry nearest a given Coordinate
 Cgeos::operation::valid::MakeValidThe function attempts to create a valid representation of a given invalid geometry without losing any of the input vertices
 Cgeos::operation::overlayng::MaximalEdgeRing
 Cgeos::algorithm::construct::MaximumInscribedCircle
 Cgeos::noding::snapround::MCIndexPointSnapper"Snaps" all SegmentStrings in a SpatialIndex containing MonotoneChains to a given HotPixel
 Cgeos::algorithm::MinimumBoundingCircle
 Cgeos::precision::MinimumClearanceComputes the Minimum Clearance of a Geometry
 Cgeos::algorithm::MinimumDiameterComputes the minimum diameter of a geom::Geometry
 Cgeos::index::chain::MonotoneChainMonotone Chains are a way of partitioning the segments of a linestring to allow for fast searching of intersections
 Cgeos::index::chain::MonotoneChainBuilderConstructs MonotoneChains for sequences of Coordinates
 Cgeos::geomgraph::index::MonotoneChainEdgeMonotoneChains are a way of partitioning the segments of an edge to allow for fast searching of intersections
 Cgeos::geomgraph::index::MonotoneChainIndexerMonotoneChains are a way of partitioning the segments of an edge to allow for fast searching of intersections
 Cgeos::index::chain::MonotoneChainOverlapActionThe action for the internal iterator for performing overlap queries on a MonotoneChain
 Cgeos::index::chain::MonotoneChainSelectAction
 Cgeos::shape::fractal::MortonCode
 Cgeos::index::bintree::NodeBaseThe base class for nodes in a Bintree
 Cgeos::index::quadtree::NodeBaseThe base class for nodes in a Quadtree
 Cgeos::geomgraph::NodeFactory
 Cgeos::geomgraph::NodeMap
 Cgeos::planargraph::NodeMapA map of Node, indexed by the coordinate of the node
 Cgeos::noding::NoderComputes all intersections between segments in a set of SegmentString
 Cgeos::noding::NodingValidatorValidates that a collection of SegmentStrings is correctly noded. Throws a TopologyException if a noding error is found
 Cgeos::geomgraph::EdgeList::OcaCmp
 Cgeos::noding::OctantMethods for computing and working with octants of the Cartesian plane
 Cgeos::operation::buffer::OffsetCurveBuilderComputes the raw offset curve for a single Geometry component (ring, line or point)
 Cgeos::operation::buffer::OffsetCurveSetBuilderCreates all the raw offset curves for a buffer of a Geometry
 Cgeos::operation::overlay::validate::OffsetPointGeneratorGenerates points offset from both sides of all segments in a geometry
 Cgeos::operation::buffer::OffsetSegmentGenerator
 Cgeos::operation::buffer::OffsetSegmentString
 Cgeos::algorithm::OrientationFunctions to compute the orientation of basic geometric structures including point triplets (triangles) and rings
 Cgeos::noding::OrientedCoordinateArrayAllows comparing geom::CoordinateSequences in an orientation-independent way
 Cgeos::operation::geounion::OverlapUnionUnions 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::OverlayEdgeRing
 Cgeos::operation::overlayng::OverlayGraph
 Cgeos::operation::overlayng::OverlayLabel
 Cgeos::operation::overlayng::OverlayLabeller
 Cgeos::operation::overlayng::OverlayMixedPoints
 Cgeos::operation::overlayng::OverlayNG
 Cgeos::operation::overlayng::OverlayNGRobust
 Cgeos::operation::overlayng::OverlayPoints
 Cgeos::operation::overlay::validate::OverlayResultValidatorValidates that the result of an overlay operation is geometrically correct within a determined tolerance
 Cgeos::operation::overlayng::OverlayUtil
 Cgeos::geomgraph::PlanarGraphRepresents a directed graph which is embeddable in a planar surface
 Cgeos::planargraph::PlanarGraphRepresents a directed graph which is embeddable in a planar surface
 Cgeos::operation::overlay::PointBuilderConstructs geom::Point s from the nodes of an overlay graph
 Cgeos::operation::geounion::PointGeometryUnionComputes the union of a puntal geometry with another arbitrary Geometry
 Cgeos::algorithm::PointInRing
 Cgeos::algorithm::PointLocationFunctions for locating points within basic geometric structures such as lines and rings
 Cgeos::algorithm::PointLocatorComputes the topological relationship (Location) of a single point to a Geometry
 Cgeos::algorithm::locate::PointOnGeometryLocatorAn interface for classes which determine the Location of points in Polygon or MultiPolygon geometries
 Cgeos::algorithm::distance::PointPairDistance
 Cgeos::operation::overlayng::PolygonBuilder
 Cgeos::operation::overlay::PolygonBuilderForms Polygon out of a graph of geomgraph::DirectedEdge
 Cgeos::operation::polygonize::PolygonizerPolygonizes a set of Geometrys which contain linework that represents the edges of a planar graph
 Cgeos::geom::PositionA Position indicates the position of a Location relative to a graph component (Node, Edge, or Area)
 Cgeos::geom::PrecisionModelSpecifies the precision model of the Coordinate in a Geometry
 Cgeos::operation::overlayng::PrecisionReducer
 Cgeos::operation::overlayng::PrecisionUtil
 Cgeos::geom::prep::PreparedGeometryAn interface for classes which prepare Geometrys in order to optimize the performance of repeated calls to specific geometric operations
 Cgeos::geom::prep::PreparedGeometryFactoryA factory for creating PreparedGeometrys
 Cgeos::geom::prep::PreparedLineStringDistance
 Cgeos::geom::prep::PreparedLineStringIntersectsComputes the intersects spatial relationship predicate for a target PreparedLineString relative to all other Geometry classes
 Cgeos::geom::prep::PreparedLineStringNearestPoints
 Cgeos::geom::prep::PreparedPolygonDistance
 Cgeos::geom::prep::PreparedPolygonPredicateA base class for predicate operations on PreparedPolygons
 Cgeos::util::Profile
 Cgeos::util::Profiler
 Cgeos::triangulate::quadedge::QuadEdgeA class that represents the edge data structure which implements the quadedge algebra
 Cgeos::triangulate::quadedge::QuadEdgeLocatorAn 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::QuadEdgeQuartet
 Cgeos::triangulate::quadedge::QuadEdgeSubdivisionA class that contains the QuadEdges representing a planar subdivision that models a triangulation
 Cgeos::geom::QuadrantUtility functions for working with quadrants
 Cgeos::operation::valid::QuadtreeNestedRingTesterTests whether any of a set of LinearRings are nested inside another ring in the set, using a Quadtree index to speed up the comparisons
 Cgeos::algorithm::RayCrossingCounterCounts the number of segments crossed by a horizontal ray extending to the right from a given point, in an incremental fashion
 Cgeos::algorithm::RayCrossingCounterDDCounts the number of segments crossed by a horizontal ray extending to the right from a given point, in an incremental fashion
 Cgeos::operation::intersection::RectangleClipping rectangle
 Cgeos::operation::predicate::RectangleContainsOptimized implementation of spatial predicate "contains" for cases where the first Geometry is a rectangle
 Cgeos::operation::intersection::RectangleIntersectionSpeed-optimized clipping of a Geometry with a rectangle
 Cgeos::operation::intersection::RectangleIntersectionBuilderRebuild geometries from subpaths left by clipping with a rectangle
 Cgeos::operation::predicate::RectangleIntersectsOptimized implementation of the "intersects" spatial predicate for cases where one Geometry is a rectangle
 Cgeos::operation::relate::RelateComputerComputes the topological relationship between two Geometries
 Cgeos::operation::relate::RelateNodeGraphImplements the simple graph of Nodes and geomgraph::EdgeEnd which is all that is required to determine topological relationships between Geometries
 Cgeos::operation::valid::RepeatedPointRemoverRemoves repeated, consecutive equal, coordinates from a CoordinateSequence
 Cgeos::operation::valid::RepeatedPointTesterImplements the appropriate checks for repeated points (consecutive identical coordinates) as defined in the JTS spec
 Cgeos::operation::buffer::RightmostEdgeFinderA 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::RobustDeterminantImplements an algorithm to compute the sign of a 2x2 determinant for double precision values robustly
 Cruntime_error
 Cgeos::operation::predicate::SegmentIntersectionTesterTests if any line segments in two sets of CoordinateSequences intersect
 Cgeos::noding::SegmentIntersectorProcesses possible intersections detected by a Noder
 Cgeos::geomgraph::index::SegmentIntersectorComputes the intersection of line segments, and adds the intersection to the edges containing the segments
 Cgeos::noding::SegmentNodeRepresents an intersection point between two NodedSegmentString
 Cgeos::noding::SegmentNodeListA list of the SegmentNode present along a NodedSegmentString
 Cgeos::noding::SegmentNodeLT
 Cgeos::noding::SegmentPointComparatorImplements a robust method of comparing the relative position of two points along the same segment
 Cgeos::noding::SegmentSetMutualIntersectorAn intersector for the red-blue intersection problem
 Cgeos::noding::SegmentStringAn interface for classes which represent a sequence of contiguous line segments
 Cgeos::noding::SegmentStringUtilUtility methods for processing SegmentStrings
 Cgeos::operation::sharedpaths::SharedPathsOpFind shared paths among two linear Geometry objects
 Cgeos::geom::util::ShortCircuitedGeometryVisitorA visitor to Geometry elements which can be short-circuited by a given condition
 Cgeos::precision::SimpleGeometryPrecisionReducerReduces the precision of a geom::Geometry according to the supplied geom::PrecisionModel, without attempting to preserve valid topology
 Cgeos::operation::valid::SimpleNestedRingTesterTests whether any of a set of LinearRings are nested inside another ring in the set, using a simple O(n^2) comparison
 Cgeos::index::strtree::SimpleSTRdistance
 Cgeos::index::strtree::SimpleSTRpair
 Cgeos::operation::overlay::snap::SnapIfNeededOverlayOpPerforms an overlay operation using snapping and enhanced precision to improve the robustness of the result
 Cgeos::operation::overlay::snap::SnapOverlayOpPerforms an overlay operation using snapping and enhanced precision to improve the robustness of the result
 Cgeos::noding::snap::SnappingPointIndex
 Cgeos::index::intervalrtree::SortedPackedIntervalRTreeA static index on a set of 1-dimensional intervals, using an R-Tree packed based on the order of the interval midpoints
 Cgeos::index::SpatialIndexAbstract class defines basic insertion and query operations supported by classes implementing spatial index algorithms
 Cgeos::io::StringTokenizer
 Cgeos::index::strtree::SimpleSTRdistance::STRpairQueueCompare
 Cgeos::planargraph::SubgraphA subgraph of a PlanarGraph
 Cgeos::operation::buffer::SubgraphDepthLocaterLocates a subgraph inside a set of subgraphs, in order to determine the outside depth of the subgraph
 Cgeos::index::sweepline::SweepLineEvent
 Cgeos::geomgraph::index::SweepLineEvent
 Cgeos::geomgraph::index::SweepLineEventLessThen
 Cgeos::index::sweepline::SweepLineEventLessThen
 Cgeos::geomgraph::index::SweepLineEventOBJ
 Cgeos::index::sweepline::SweepLineIndexA sweepline implements a sorted index on a set of intervals
 Cgeos::index::sweepline::SweepLineInterval
 Cgeos::operation::valid::SweeplineNestedRingTesterTests whether any of a set of LinearRings are nested inside another ring in the set, using an SweepLineIndex to speed up the comparisons
 Cgeos::index::sweepline::SweepLineOverlapAction
 Cgeos::simplify::TaggedLinesSimplifierSimplifies a collection of TaggedLineStrings, preserving topology (in the sense that no new intersections are introduced)
 Cgeos::simplify::TaggedLineStringContains and owns a list of TaggedLineSegments
 Cgeos::simplify::TaggedLineStringSimplifierSimplifies a TaggedLineString, preserving topology (in the sense that no new intersections are introduced). Uses the recursive Douglas-Peucker algorithm
 Cgeos::geomgraph::TopologyLocationA TopologyLocation is the labelling of a GraphComponent's topological relationship to a single Geometry
 Cgeos::simplify::TopologyPreservingSimplifierSimplifies a geometry, ensuring that the result is a valid geometry having the same dimension and number of components as the input
 Cgeos::operation::valid::TopologyValidationErrorContains information about the nature and location of a geom::Geometry validation error
 Cgeos::geom::TriangleRepresents a planar triangle, and provides methods for calculating various properties of triangles
 Cgeos::geom::TrianglePredicateAlgorithms for computing values and predicates associated with triangles
 Cgeos::triangulate::quadedge::TriangleVisitorAn interface for algorithms which process the triangles in a QuadEdgeSubdivision
 Cgeos::operation::overlayng::UnaryUnionNG
 Cgeos::operation::geounion::UnaryUnionOpUnions a collection of Geometry or a single Geometry (which may be a collection) together
 Cgeos::operation::geounion::UnionStrategy
 Cgeos::io::Unload
 Cvector
 Cgeos::triangulate::quadedge::VertexModels a site (node) in a QuadEdgeSubdivision
 Cgeos::triangulate::VoronoiDiagramBuilderA utility class which creates Voronoi Diagrams from collections of points
 Cgeos::io::WKBReaderReads a Geometry from Well-Known Binary format
 Cgeos::io::WKBWriterWrites a Geometry into Well-Known Binary format
 Cgeos::io::WKTReaderWKT parser class; see also WKTWriter
 Cgeos::io::WKTWriterOutputs the textual representation of a Geometry. See also WKTReader
 Cgeos::io::Writer