|
class | AcyclicSubgraphModule |
| Base class of algorithms for computing a maximal acyclic subgraph. More...
|
|
class | AdjacencyOracle |
| Tells you in constant time if two nodes are adjacent. More...
|
|
class | AdjElement |
| Class for adjacency list elements. More...
|
|
class | AdjEntrySet |
| AdjEntry sets. More...
|
|
class | AdjHypergraphElement |
| Class for adjacency list elements. More...
|
|
class | AlgorithmFailureException |
| Exception thrown when an algorithm realizes an internal bug that prevents it from continuing. More...
|
|
class | Array |
| The parameterized class Array implements dynamic arrays of type E. More...
|
|
class | Array2D |
| The parameterized class Array2D implements dynamic two-dimensional arrays. More...
|
|
class | ArrayBuffer |
| An array that keeps track of the number of inserted elements; also usable as an efficient stack. More...
|
|
class | ArrayLevel |
| The simple implementation of LevelBase interface. More...
|
|
class | ArrayReverseIteratorBase |
| Random-access reverse iterator based on a pointer to an array element. More...
|
|
class | AStarSearch |
| A-Star informed search algorithm. More...
|
|
class | AugmentationModule |
| The base class for graph augmentation algorithms. More...
|
|
class | BalloonLayout |
|
class | Barrier |
| Representation of a barrier. More...
|
|
class | BarycenterHeuristic |
| The barycenter heuristic for 2-layer crossing minimization. More...
|
|
class | BarycenterPlacer |
| The barycenter placer for multilevel layout. More...
|
|
class | BasicPageRank |
| Basic page rank calculation. More...
|
|
class | BCTree |
| Static BC-trees. More...
|
|
class | BendString |
| Represents the bends on an edge e consisting of vertical and horizontal segments. More...
|
|
class | BertaultLayout |
|
class | BiconnectedShellingOrder |
| Computation of the shelling order for biconnected graphs. More...
|
|
class | BinaryHeap |
| Heap realized by a data array. More...
|
|
class | BinaryHeapSimple |
| Dynamically growing binary heap tuned for efficiency on a small interface (compared to BinaryHeap). More...
|
|
class | BinomialHeap |
| Binomial heap implementation. More...
|
|
struct | BinomialHeapNode |
| Binomial heap node. More...
|
|
class | BitonicOrdering |
|
class | Block |
| Class representing idea of Blocks used in GlobalSifting and GridSifting algorithms. More...
|
|
class | BlockOrder |
| Hierarchical graph representation used by GlobalSifting and GridSifting algorithms. More...
|
|
class | BoothLueker |
| Booth-Lueker planarity test. More...
|
|
class | BoundedQueue |
| The parameterized class BoundedQueue implements queues with bounded size. More...
|
|
class | BoyerMyrvold |
| Wrapper class used for preprocessing and valid invocation of the planarity test. More...
|
|
class | BoyerMyrvoldPlanar |
| This class implements the extended BoyerMyrvold planarity embedding algorithm. More...
|
|
class | BucketEdgeArray |
| Bucket function for edges. More...
|
|
class | BucketFunc |
| Abstract base class for bucket functions. More...
|
|
class | BucketSourceIndex |
| Bucket function using the index of an edge's source node as bucket. More...
|
|
class | BucketTargetIndex |
| Bucket function using the index of an edge's target node as bucket. More...
|
|
class | CCLayoutPackModule |
| Base class of algorithms that arrange/pack layouts of connected components. More...
|
|
class | CconnectClusterPlanar |
| C-planarity test by Cohen, Feng and Eades. More...
|
|
class | CconnectClusterPlanarEmbed |
| C-planarity test and embedding by Cohen, Feng and Eades. More...
|
|
class | CconnectClusterPlanarityModule |
|
class | CirclePlacer |
| The circle placer for multilevel layout. More...
|
|
class | CircularLayout |
| The circular layout algorithm. More...
|
|
class | CliqueFinderHeuristic |
| Finds cliques and dense subgraphs using a heuristic. More...
|
|
class | CliqueFinderModule |
| Finds cliques. More...
|
|
class | CliqueFinderSPQR |
| Finds cliques using SPQR trees. More...
|
|
class | ClusterAnalysis |
|
class | ClusterArrayBase |
| RegisteredArray for labeling the clusters of a ClusterGraph. More...
|
|
class | ClusterElement |
| Representation of clusters in a clustered graph. More...
|
|
class | Clusterer |
|
class | ClustererModule |
| Interface for algorithms that compute a clustering for a given graph. More...
|
|
class | ClusterGraph |
| Representation of clustered graphs. More...
|
|
class | ClusterGraphAttributes |
| Stores additional attributes of a clustered graph (like layout information). More...
|
|
class | ClusterGraphCopy |
|
class | ClusterGraphCopyAttributes |
| Manages access on copy of an attributed clustered graph. More...
|
|
class | ClusterGraphObserver |
| Abstract base class for cluster graph observers. More...
|
|
class | ClusterOrthoLayout |
| Represents a planar orthogonal drawing algorithm for c-planar, c-connected clustered graphs. More...
|
|
class | ClusterOrthoShaper |
| Computes the orthogonal representation of a clustered graph. More...
|
|
class | ClusterPlanarityModule |
|
class | ClusterPlanarizationLayout |
| The cluster planarization layout algorithm. More...
|
|
class | ClusterPlanRep |
| Planarized representations for clustered graphs. More...
|
|
class | ClusterSet |
| Cluster sets. More...
|
|
class | CoffmanGrahamRanking |
| The coffman graham ranking algorithm. More...
|
|
class | CoinManager |
| If you use COIN-OR, you should use this class. More...
|
|
class | Color |
| Colors represented as RGBA values. More...
|
|
class | CombinatorialEmbedding |
| Combinatorial embeddings of planar graphs with modification functionality. More...
|
|
class | CommonCompactionConstraintGraphBase |
| Base class for ogdf::CompactionConstraintGraphBase. More...
|
|
class | CompactionConstraintGraph |
| Represents a constraint graph used for compaction. More...
|
|
class | CompactionConstraintGraphBase |
| Class implementing template-parameter-independent behaviour of ogdf::CompactionConstraintGraph. More...
|
|
class | ComponentSplitterLayout |
|
class | Configuration |
| Provides information about how OGDF has been configured. More...
|
|
class | ConnectivityTester |
| Naive implementation for testing the connectivity of a graph. More...
|
|
class | ConstCombinatorialEmbedding |
| Combinatorial embeddings of planar graphs. More...
|
|
class | ConvexHull |
| Computes the convex hull of a set of points or a layout. More...
|
|
class | CPlanarEdgeInserter |
| Edge insertion algorithm for clustered graphs. More...
|
|
class | CPlanarSubClusteredGraph |
| Constructs a c-planar subclustered graph of the input based on a spanning tree. More...
|
|
class | CPlanarSubgraphModule |
| Interface of algorithms for the computation of c-planar subgraphs. More...
|
|
class | CrossingMinimalPosition |
| Compute a crossing minimal position for a vertex. More...
|
|
class | CrossingMinimalPositionApx |
|
class | CrossingMinimalPositionApxWeighted |
|
class | CrossingMinimizationModule |
| Base class for crossing minimization algorithms. More...
|
|
class | CrossingsMatrix |
| Implements crossings matrix which is used by some TwoLayerCrossingMinimization heuristics (e.g. split) More...
|
|
class | CrossingVertexOrder |
|
class | DavidsonHarel |
| The Davidson-Harel approach for drawing graphs. More...
|
|
class | DavidsonHarelLayout |
| The Davidson-Harel layout algorithm. More...
|
|
class | DefHashFunc |
| Default hash functions. More...
|
|
class | DefHashFunc< double > |
| Specialized default hash function for double. More...
|
|
class | DefHashFunc< IPoint > |
|
class | DefHashFunc< string > |
| Specialized default hash function for string. More...
|
|
class | DefHashFunc< void * > |
| Specialized default hash function for pointer types. More...
|
|
class | DeletingTop10Heap |
| A variant of Top10Heap which deletes the elements that get rejected from the heap. More...
|
|
class | DfsAcyclicSubgraph |
| DFS-based algorithm for computing a maximal acyclic subgraph. More...
|
|
class | DfsMakeBiconnected |
| Implementation of a DFS-based algorithm for biconnectivity augmentation. More...
|
|
class | Dijkstra |
| Dijkstra's single source shortest path algorithm. More...
|
|
class | DIntersectableRect |
| Rectangles with real coordinates. More...
|
|
class | DisjointSets |
| A Union/Find data structure for maintaining disjoint sets. More...
|
|
class | DLParser |
|
class | DominanceLayout |
|
class | DPolygon |
| Polygons with real coordinates. More...
|
|
class | DRect |
| Rectangles with real coordinates. More...
|
|
class | DTreeMultilevelEmbedder |
|
class | DTreeMultilevelEmbedder2D |
|
class | DTreeMultilevelEmbedder3D |
|
class | DualGraphBase |
| A dual graph including its combinatorial embedding of an embedded graph. More...
|
|
class | DynamicBCTree |
| Dynamic BC-trees. More...
|
|
class | DynamicCastFailedException |
| Exception thrown when result of cast is 0. More...
|
|
class | DynamicPlanarSPQRTree |
| SPQR-trees of planar graphs. More...
|
|
class | DynamicSkeleton |
| Skeleton graphs of nodes in a dynamic SPQR-tree. More...
|
|
class | DynamicSPQRForest |
| Dynamic SPQR-forest. More...
|
|
class | DynamicSPQRTree |
| Linear-time implementation of dynamic SPQR-trees. More...
|
|
class | EdgeComparer |
| Compares adjacency entries based on the position of the nodes given by GraphAttribute layout information. More...
|
|
class | EdgeComparerSimple |
| Compares incident edges of a node based on the position of the last bend point or the position of the adjacent node given by the layout information of the graph. More...
|
|
class | EdgeCoverMerger |
| The edge cover merger for multilevel layout. More...
|
|
class | EdgeElement |
| Class for the representation of edges. More...
|
|
class | EdgeIndependentSpanningTrees |
| Calculates k edge-independent spanning trees of a graph. More...
|
|
class | EdgeInsertionModule |
| Interface for edge insertion algorithms. More...
|
|
class | EdgeLabel |
|
class | EdgeOrderComparer |
| Orders edges such that they do not cross each other when embeddded as insertion paths. More...
|
|
class | EdgeRouter |
| Places node boxes in replacement areas of orthogonal drawing step and route edges to minimize bends. More...
|
|
class | EdgeSet |
| Edge sets. More...
|
|
class | EdgeStandardRep |
| Edge standard representation of hypergraphs. More...
|
|
class | EdgeWeightedGraph |
|
class | EdgeWeightedGraphCopy |
|
class | ELabelInterface |
|
class | ELabelPosSimple |
|
class | EmbedderMaxFace |
| Embedder that maximizes the external face. More...
|
|
class | EmbedderMaxFaceBiconnectedGraphs |
| Embedder that maximizing the external face. More...
|
|
class | EmbedderMaxFaceBiconnectedGraphsLayers |
| Embedder that maximizes the external face (plus layers approach). More...
|
|
class | EmbedderMaxFaceLayers |
| Embedder that maximizes the external face and optimizes the position of blocks afterwards. More...
|
|
class | EmbedderMinDepth |
| Embedder that minimizes block-nesting depth. More...
|
|
class | EmbedderMinDepthMaxFace |
| Embedding that minimizes block-nesting depth and maximizes the external face. More...
|
|
class | EmbedderMinDepthMaxFaceLayers |
| Planar graph embedding that minimizes block-nesting depth and maximizes the external face and optimizes the position of blocks afterwards. More...
|
|
class | EmbedderMinDepthPiTa |
| Embedder that minimizes block-nesting depth for given embedded blocks. More...
|
|
class | EmbedderModule |
| Base class for embedder algorithms. More...
|
|
class | EmbedderOptimalFlexDraw |
| The algorithm computes a planar embedding with minimum cost. More...
|
|
class | ENGLayer |
| Represents layer in an extended nesting graph. More...
|
|
class | EpsilonTest |
|
class | Exception |
| Base class of all ogdf exceptions. More...
|
|
class | ExpansionGraph |
| Represents expansion graph of each biconnected component of a given digraph, i.e., each vertex v with in- and outdegree greater than 1 is expanded into two vertices x and y connected by an edge x->y such that all incoming edges are moved from v to x and all outgoing edges from v to y. More...
|
|
class | ExtendedNestingGraph |
|
struct | ExternE |
| List of externally active nodes strictly between x and y for minortypes B and E More...
|
|
class | ExtractKuratowskis |
| Extracts multiple Kuratowski Subdivisions. More...
|
|
class | FaceArrayBase |
| RegisteredArray for labeling the faces of a CombinatorialEmbedding. More...
|
|
class | FaceElement |
| Faces in a combinatorial embedding. More...
|
|
class | FaceSet |
| Face sets. More...
|
|
class | FaceSinkGraph |
|
class | FastHierarchyLayout |
| Coordinate assignment phase for the Sugiyama algorithm by Buchheim et al. More...
|
|
class | FastMultipoleEmbedder |
| The fast multipole embedder approach for force-directed layout. More...
|
|
class | FastMultipoleMultilevelEmbedder |
| The fast multipole multilevel embedder approach for force-directed multilevel layout. More...
|
|
class | FastSimpleHierarchyLayout |
| Coordinate assignment phase for the Sugiyama algorithm by Ulrik Brandes and Boris Köpf. More...
|
|
class | FibonacciHeap |
| Fibonacci heap implementation. More...
|
|
struct | FibonacciHeapNode |
| Fibonacci heap node. More...
|
|
struct | Fill |
| Properties of fills. More...
|
|
class | FilteringBFS |
| An iterator-based BFS through a Graph. More...
|
|
class | FilteringBFSIterator |
|
class | FindKuratowskis |
| This class collects information about Kuratowski Subdivisions which is used for extraction later. More...
|
|
class | FixedEmbeddingInserter |
| Inserts edges optimally into an embedding. More...
|
|
class | FixedEmbeddingInserterUML |
| Edge insertion module that inserts each edge optimally into a fixed embedding. More...
|
|
class | FixedEmbeddingUpwardEdgeInserter |
| Edge insertion module that inserts each edge optimally into a fixed embedding. More...
|
|
class | FixEdgeInserterCore |
|
class | FixEdgeInserterUMLCore |
|
class | FlowCompaction |
| represents compaction algorithm using min-cost flow in the dual of the constraint graph More...
|
|
class | FMMMLayout |
| The fast multipole multilevel layout algorithm. More...
|
|
class | FMMMOptions |
|
class | ForceLayoutModule |
| Interface of general layout algorithms. More...
|
|
struct | FourBlockTree |
| A node in a 4-block tree. More...
|
|
class | FPPLayout |
| The class FPPLayout represents the layout algorithm by de Fraysseix, Pach, Pollack [DPP90]. More...
|
|
class | FUPSModule |
| Interface for feasible upward planar subgraph algorithms. More...
|
|
class | FUPSSimple |
|
class | GEMLayout |
| The energy-based GEM layout algorithm. More...
|
|
struct | GenericComparer |
| Compare elements based on a single comparable attribute. More...
|
|
class | GenericLine |
| Infinite lines. More...
|
|
class | GenericPoint |
| Parameterized base class for points. More...
|
|
class | GenericPolyline |
| Polylines with PointType points. More...
|
|
class | GenericSegment |
| Finite line segments. More...
|
|
class | GeometricEdgeInsertion |
|
class | GeometricVertexInsertion |
|
class | GF2Solver |
|
class | GlobalSifting |
| The global sifting heuristic for crossing minimization. More...
|
|
class | GlueMap |
| This is a helper class to make the glueing of two edges simpler. More...
|
|
class | Graph |
| Data type for general directed graphs (adjacency list representation). More...
|
|
class | GraphAdjIterator |
| Iterator for AdjEntries of a graph. More...
|
|
class | GraphAttributes |
| Stores additional attributes of a graph (like layout information). More...
|
|
class | GraphCopy |
| Copies of graphs supporting edge splitting. More...
|
|
class | GraphCopyBase |
|
class | GraphCopySimple |
| Copies of graphs with mapping between nodes and edges. More...
|
|
class | GraphIO |
| Utility class providing graph I/O in various exchange formats. More...
|
|
class | GraphMLParser |
|
class | GraphObserver |
| Abstract Base class for graph observers. More...
|
|
class | GraphReduction |
| Creates a reduced graph by removing leaves, self-loops, and reducing chains. More...
|
|
class | GreedyCycleRemoval |
| Greedy algorithm for computing a maximal acyclic subgraph. More...
|
|
class | GreedyInsertHeuristic |
| The greedy-insert heuristic for 2-layer crossing minimization. More...
|
|
class | GreedySwitchHeuristic |
| The greedy-switch heuristic for 2-layer crossing minimization. More...
|
|
class | GridLayout |
| Representation of a graph's grid layout. More...
|
|
class | GridLayoutMapped |
| Extends GridLayout by a grid mapping mechanism. More...
|
|
class | GridLayoutModule |
| Base class for grid layout algorithms. More...
|
|
class | GridLayoutPlanRepModule |
| Base class for grid layout algorithms operating on a PlanRep. More...
|
|
class | GridSifting |
| The grid sifting heuristic for crossing minimization. More...
|
|
class | HananiTutteCPlanarity |
| C-planarity testing via Hanani-Tutte approach. More...
|
|
class | HashArray |
| Indexed arrays using hashing for element access. More...
|
|
class | HashArray2D |
| Indexed 2-dimensional arrays using hashing for element access. More...
|
|
class | HashConstIterator |
| Iterators for hash tables. More...
|
|
class | HashConstIterator2D |
| Const-iterator for 2D-hash arrays. More...
|
|
class | HashElement |
| Representation of elements in a hash table. More...
|
|
class | HashElementBase |
| Base class for elements within a hash table. More...
|
|
class | HashFuncTuple |
|
class | Hashing |
| Hashing with chaining and table doubling. More...
|
|
class | HashingBase |
| Base class for hashing with chaining and table doubling. More...
|
|
class | HeapBase |
| Common interface for all heap classes. More...
|
|
class | Hierarchy |
| Representation of proper hierarchies used by Sugiyama-layout. More...
|
|
class | HierarchyClusterLayoutModule |
| Interface of hierarchy layout algorithms for cluster graphs. More...
|
|
class | HierarchyLayoutModule |
| Interface of hierarchy layout algorithms. More...
|
|
class | HierarchyLevels |
| Representation of proper hierarchies used by Sugiyama-layout. More...
|
|
class | HierarchyLevelsBase |
|
class | HotQueue |
| Heap-on-Top queue implementation. More...
|
|
struct | HotQueueHandle |
| Heap-on-Top handle to inserted items. More...
|
|
struct | HotQueueNode |
| Heap-on-Top bucket element. More...
|
|
class | HyperedgeElement |
| Class for the representation of hyperedges. More...
|
|
class | Hypergraph |
|
class | HypergraphAttributes |
| Stores additional attributes of a hypergraph. More...
|
|
class | HypergraphAttributesES |
| Stores additional attributes of edge standard representation of a hypergraph. More...
|
|
class | HypergraphLayoutES |
|
class | HypergraphLayoutModule |
| Interface of hypergraph layout algorithms. More...
|
|
class | HypergraphObserver |
|
class | HypergraphRegisteredArray |
| RegisteredArray for nodes and edges of a hypergraph. More...
|
|
class | HypergraphRegistry |
| Registry for nodes and edges of a hypergraph. More...
|
|
class | HypernodeElement |
| Class for the representation of hypernodes. More...
|
|
class | ILPClusterPlanarity |
| C-planarity testing via completely connected graph extension. More...
|
|
class | IncNodeInserter |
|
class | IndependentSetMerger |
| The independent set merger for multilevel layout. More...
|
|
class | Initialization |
| The class Initialization is used for initializing global variables. More...
|
|
class | InitialPlacer |
| Base class for placer modules. More...
|
|
struct | InOutPoint |
| Representation of an in- or outpoint. More...
|
|
class | InsufficientMemoryException |
| Exception thrown when not enough memory is available to execute an algorithm. More...
|
|
class | IOPoints |
| Representation of in- and outpoint lists. More...
|
|
class | KuratowskiStructure |
| A Kuratowski Structure is a special graph structure containing severals subdivisions. More...
|
|
class | KuratowskiSubdivision |
|
class | KuratowskiWrapper |
| Wrapper-class for Kuratowski Subdivisions containing the minortype and edgelist. More...
|
|
class | LayerBasedUPRLayout |
|
class | LayerByLayerSweep |
| Interface of two-layer crossing minimization algorithms. More...
|
|
class | LayeredCrossMinModule |
| Interface of crossing minimization algorithms for layered graphs. More...
|
|
class | Layout |
| Stores a layout of a graph (coordinates of nodes, bend points of edges). More...
|
|
class | LayoutClusterPlanRepModule |
| Interface for planar cluster layout algorithms. More...
|
|
class | LayoutModule |
| Interface of general layout algorithms. More...
|
|
class | LayoutPlanRepModule |
| Interface for planar layout algorithms (used in the planarization approach). More...
|
|
class | LayoutPlanRepUMLModule |
| Interface for planar UML layout algorithms. More...
|
|
class | LayoutStandards |
| Standard values for graphical attributes and layouts. More...
|
|
class | LayoutStatistics |
| Computes statistical information about a layout. More...
|
|
class | LCA |
| Implements the <O(n log n), O(1)>-time "sparse table" algorithm by Bender and Farach-Colton to compute lowest common ancestors (LCAs) in arborescences (not arbitrary directed acyclic graphs). More...
|
|
class | LeftistOrdering |
|
class | Level |
| Representation of levels in hierarchies. More...
|
|
class | LevelBase |
| Representation of levels in hierarchies. More...
|
|
class | LHTreeNode |
|
class | LibraryNotSupportedException |
| Exception thrown when an external library shall be used which is not supported. More...
|
|
class | LinearLayout |
| Layout the graph with nodes next to each other with natural or custom order and draw the edges as semicircular bows above them. More...
|
|
class | List |
| Doubly linked lists (maintaining the length of the list). More...
|
|
class | ListContainer |
|
class | ListElement |
| Structure for elements of doubly linked lists. More...
|
|
class | ListIteratorBase |
| Encapsulates a pointer to a list element. More...
|
|
class | ListPure |
| Doubly linked lists. More...
|
|
class | LocalBiconnectedMerger |
| The local biconnected merger for multilevel layout. More...
|
|
class | Logger |
| Centralized global and local logging facility working on streams like std::cout . More...
|
|
class | LongestPathCompaction |
| Compaction algorithm using longest paths in the constraint graph. More...
|
|
class | LongestPathRanking |
| The longest-path ranking algorithm. More...
|
|
class | LPSolver |
|
class | MallocMemoryAllocator |
| Implements a simple memory manager using malloc() and free() . More...
|
|
class | MatchingBlossom |
| Implementation of the Blossom-I algorithm by Edmonds (1965) for Minimum Weight Perfect Matching. More...
|
|
class | MatchingBlossomV |
| Implementation of the Blossom-V algorithm by Kolmogorov (2009) for Minimum Weight Perfect Matching. More...
|
|
class | MatchingMerger |
| The matching merger for multilevel layout. More...
|
|
class | MatchingModule |
|
class | MaxAdjOrdering |
| Calculate one or all Maximum Adjacency Ordering(s) of a given simple undirected graph. More...
|
|
class | MaxFlowEdmondsKarp |
| Computes a max flow via Edmonds-Karp. More...
|
|
class | MaxFlowGoldbergTarjan |
| Computes a max flow via Preflow-Push (global relabeling and gap relabeling heuristic). More...
|
|
class | MaxFlowModule |
|
class | MaxFlowSTPlanarDigraph |
| Computes a max flow in s-t-planar network via dual shortest paths. More...
|
|
class | MaxFlowSTPlanarItaiShiloach |
| Computes a max flow in s-t-planar network via uppermost paths. More...
|
|
class | MaximalFUPS |
|
class | MaximalPlanarSubgraphSimple< TCost, typename std::enable_if< std::is_floating_point< TCost >::value >::type > |
|
class | MaximalPlanarSubgraphSimple< TCost, typename std::enable_if< std::is_integral< TCost >::value >::type > |
| Naive maximal planar subgraph approach that extends a configurable non-maximal subgraph heuristic. More...
|
|
class | MaximumCPlanarSubgraph |
| Exact computation of a maximum c-planar subgraph. More...
|
|
class | MaximumPlanarSubgraph |
| Exact computation of a maximum planar subgraph. More...
|
|
class | MaxSequencePQTree |
| The class template MaxSequencePQTree is designed to compute a maximal consecutive sequence of pertinent leaves in a PQ-tree. More...
|
|
class | MedianHeuristic |
| The median heuristic for 2-layer crossing minimization. More...
|
|
class | MedianPlacer |
| The median placer for multilevel layout. More...
|
|
class | MinCostFlowModule |
| Interface for min-cost flow algorithms. More...
|
|
class | MinCostFlowReinelt |
| Computes a min-cost flow using a network simplex method. More...
|
|
class | MinimumCutModule |
| Serves as an interface for various methods to compute minimum cuts with or without edge weights. More...
|
|
class | MinimumCutNagamochiIbaraki |
| Calculate minimum cut value for a given Graph. More...
|
|
struct | MinimumCutStoerWagner |
| Computes a minimum cut in a graph. More...
|
|
class | MinimumEdgeDistances |
| Maintains input sizes for improvement compaction (deltas and epsilons) More...
|
|
class | MinSTCutBFS |
| Min-st-cut algorithm, that calculates the cut by doing a depth first search over the dual graph of of an st-planar input graph. More...
|
|
class | MinSTCutDijkstra |
| Min-st-cut algorithm, that calculates the cut by calculating the shortest path between the faces adjacent to an edge between s and t, via the algorithm by Dijkstra on the dual graph. More...
|
|
class | MinSTCutMaxFlow |
| Min-st-cut algorithm, that calculates the cut via maxflow. More...
|
|
class | MinSTCutModule |
|
class | MinSteinerTreeDirectedCut |
| This class implements the Directed Cut Integer Linear Program for the Steiner tree problem. More...
|
|
class | MinSteinerTreeDualAscent |
| Dual ascent heuristic for the minimum Steiner tree problem. More...
|
|
class | MinSteinerTreeGoemans139 |
| This class implements the (1.39+epsilon)-approximation algorithm for the Steiner tree problem by Goemans et. More...
|
|
class | MinSteinerTreeKou |
| This class implements the Minimum Steiner Tree 2-approximation algorithm by Kou et al. More...
|
|
class | MinSteinerTreeMehlhorn |
| This class implements the Minimum Steiner Tree 2-approximation algorithm by Mehlhorn. More...
|
|
class | MinSteinerTreeModule |
| Serves as an interface for various methods to compute or approximate minimum Steiner trees on undirected graphs with edge costs. More...
|
|
class | MinSteinerTreePrimalDual |
| Primal-Dual approximation algorithm for Steiner tree problems. More...
|
|
class | MinSteinerTreeRZLoss |
| This class implements the loss-contracting (1.55+epsilon)-approximation algorithm for the Steiner tree problem by Robins and Zelikovsky. More...
|
|
class | MinSteinerTreeShore |
| Implementation of Shore, Foulds and Gibbons exact branch and bound algorithm for solving Steiner tree problems. More...
|
|
class | MinSteinerTreeTakahashi |
| This class implements the minimum Steiner tree 2-approximation algorithm by Takahashi and Matsuyama with improvements proposed by Poggi de Aragao et al. More...
|
|
class | MinSteinerTreeZelikovsky |
| This class implements the 11/6-approximation algorithm by Zelikovsky for the minimum Steiner tree problem along with variants and practical improvements. More...
|
|
class | MixedModelBase |
|
class | MixedModelCrossingsBeautifierModule |
| The base class for Mixed-Model crossings beautifier algorithms. More...
|
|
class | MixedModelLayout |
| Implementation of the Mixed-Model layout algorithm. More...
|
|
class | MMCBBase |
| common base class for MMCBDoubleGrid and MMCBLocalStretch. More...
|
|
class | MMCBDoubleGrid |
| Crossings beautifier using grid doubling. More...
|
|
class | MMCBLocalStretch |
| Crossings beautifier using a local stretch strategy. More...
|
|
class | MMCrossingMinimizationModule |
| Interface for minor-monotone crossing minimization algorithms. More...
|
|
class | MMDummyCrossingsBeautifier |
| Dummy implementation of Mixed-Model crossings beautifier. More...
|
|
class | MMEdgeInsertionModule |
| Interface for minor-monotone edge insertion algorithms. More...
|
|
class | MMFixedEmbeddingInserter |
| Minor-monotone edge insertion with fixed embedding. More...
|
|
class | MMOrder |
|
class | MMSubgraphPlanarizer |
| Planarization approach for minor-monotone crossing minimization. More...
|
|
class | MMVariableEmbeddingInserter |
| Minor-monotone edge insertion with variable embedding. More...
|
|
class | ModifiedNibbleClusterer |
| The modified nibble clustering algorithm. More...
|
|
class | ModularMultilevelMixer |
| Modular multilevel graph layout. More...
|
|
class | Module |
| Base class for modules. More...
|
|
class | MultiEdgeApproxInserter |
| Multi edge inserter with approximation guarantee. More...
|
|
class | MultilevelBuilder |
| Base class for merger modules. More...
|
|
class | MultilevelGraph |
|
class | MultilevelLayout |
| The multilevel drawing framework. More...
|
|
class | MultilevelLayoutModule |
| Interface of general layout algorithms that also allow a MultilevelGraph as call parameter, extending the interface of a simple LayoutModule. More...
|
|
class | NearestRectangleFinder |
| Finds in a given set of rectangles for each point in a given set of points the nearest rectangle. More...
|
|
class | NodeColoringBergerRompel |
| Approximation algorithms for the node coloring problem in graphs. More...
|
|
class | NodeColoringBoppanaHalldorsson |
| Approximation algorithms for the node coloring problem in graphs. More...
|
|
class | NodeColoringHalldorsson |
| Approximation algorithms for the node coloring problem in graphs. More...
|
|
class | NodeColoringJohnson |
| Approximation algorithms for the node coloring problem in graphs. More...
|
|
class | NodeColoringModule |
| Approximation algorithms for the node coloring problem in graphs. More...
|
|
class | NodeColoringRecursiveLargestFirst |
| A simple greedy node coloring heuristic in graphs. More...
|
|
class | NodeColoringSequential |
| Approximation algorithms for the node coloring problem in graphs. More...
|
|
class | NodeColoringSimple |
| Approximation algorithms for the node coloring problem in graphs. More...
|
|
class | NodeColoringWigderson |
| Approximation algorithms for the node coloring problem in graphs. More...
|
|
class | NodeElement |
| Class for the representation of nodes. More...
|
|
struct | NodeMerge |
|
struct | NodePair |
|
class | NodeRespecterLayout |
| The NodeRespecterLayout layout algorithm. More...
|
|
class | NodeSet |
| Node sets. More...
|
|
class | NonPlanarCore |
| Non-planar core reduction. More...
|
|
class | NoStdComparerException |
| Exception thrown when a required standard comparer has not been specialized. More...
|
|
class | Observable |
| Base class for an observable object that can be tracked by multiple Observer objects. More...
|
|
class | Observer |
| Base class for an observer for a single Observable object. More...
|
|
struct | OGDFAllocator |
| Encapsulates OGDF_ALLOCATOR in a class that can be used as the Allocator for containers of the C++ standard library. More...
|
|
class | OptimalHierarchyClusterLayout |
| The LP-based hierarchy cluster layout algorithm. More...
|
|
class | OptimalHierarchyLayout |
| The LP-based hierarchy layout algorithm. More...
|
|
class | OptimalRanking |
| The optimal ranking algorithm. More...
|
|
class | OrderComparer |
|
class | OrthoLayout |
| The Orthogonal layout algorithm for planar graphs. More...
|
|
class | OrthoLayoutUML |
| Represents planar orthogonal drawing algorithm for mixed-upward planar embedded graphs (UML-diagrams) More...
|
|
class | OrthoRep |
| Orthogonal representation of an embedded graph. More...
|
|
class | OrthoShaper |
|
class | OverlappingGraphCopies |
| The manager class for multiple OverlappingGraphCopy instances of the same graph. More...
|
|
class | OverlappingGraphCopy |
| Version of GraphCopySimple that may efficiently share some overlap with other instances of the same original Graph via its OverlappingGraphCopies manager. More...
|
|
class | PairingHeap |
| Pairing heap implementation. More...
|
|
struct | PairingHeapNode |
| Pairing heap node. More...
|
|
class | PALabel |
| auxiliary class for the planar augmentation algorithm More...
|
|
class | PertinentGraph |
| Pertinent graphs of nodes in an SPQR-tree. More...
|
|
class | PivotMDS |
| The Pivot MDS (multi-dimensional scaling) layout algorithm. More...
|
|
class | PlanarAugmentation |
| The algorithm for planar biconnectivity augmentation (Mutzel, Fialko). More...
|
|
class | PlanarAugmentationFix |
| The algorithm for biconnectivity augmentation with fixed combinatorial embedding. More...
|
|
class | PlanarDrawLayout |
| Implementation of the Planar-Draw layout algorithm. More...
|
|
class | PlanarGridLayoutModule |
| Base class for planar grid layout algorithms. More...
|
|
class | PlanarityModule |
| Module for planarity testing and planar embeddings. More...
|
|
class | PlanarizationGridLayout |
| The planarization grid layout algorithm. More...
|
|
class | PlanarizationLayout |
| The planarization approach for drawing graphs. More...
|
|
class | PlanarizationLayoutUML |
| The planarization layout algorithm. More...
|
|
class | PlanarizerChordlessCycle |
|
class | PlanarizerMixedInsertion |
|
class | PlanarizerStarReinsertion |
| The star (re-)insertion approach for crossing minimization. More...
|
|
class | PlanarSeparatorModule |
| Abstract description of all planar separator algorithms. More...
|
|
class | PlanarSPQRTree |
| SPQR-trees of planar graphs. More...
|
|
class | PlanarStraightLayout |
| Implementation of the Planar-Straight layout algorithm. More...
|
|
class | PlanarSubgraphBoyerMyrvold |
| Maximum planar subgraph heuristic based on the Boyer-Myrvold planarity test. More...
|
|
class | PlanarSubgraphCactus |
| Maximum planar subgraph approximation algorithm by Calinescu et al. More...
|
|
class | PlanarSubgraphEmpty |
| Dummy implementation for maximum planar subgraph that returns an empty graph. More...
|
|
class | PlanarSubgraphFast |
| Computation of a planar subgraph using PQ-trees. More...
|
|
class | PlanarSubgraphModule |
| Interface for planar subgraph algorithms. More...
|
|
class | PlanarSubgraphPQTree |
|
class | PlanarSubgraphTree |
| Maximum planar subgraph heuristic that yields a spanning tree. More...
|
|
class | PlanarSubgraphTriangles |
| Maximum planar subgraph approximation algorithms by Chalermsook/Schmid and Calinescu et al. More...
|
|
class | PlanRep |
| Planarized representations (of a connected component) of a graph. More...
|
|
class | PlanRepExpansion |
| Planarized representations (of a connected component) of a graph. More...
|
|
class | PlanRepInc |
| This class is only an adaption of PlanRep for the special incremental drawing case. More...
|
|
class | PlanRepLight |
| Light-weight version of a planarized representation, associated with a PlanRep. More...
|
|
class | PlanRepUML |
| Planarized representation (of a connected component) of a UMLGraph; allows special handling of hierarchies in the graph. More...
|
|
class | PoolMemoryAllocator |
| Allocates memory in large chunks for better runtime. More...
|
|
class | PQBasicKey |
|
class | PQBasicKeyRoot |
| The class PQBasicKeyRoot is used as a base class of the class template basicKey. More...
|
|
class | PQInternalKey |
| The class template PQInternalKey is a derived class of class template PQBasicKey. More...
|
|
class | PQInternalNode |
| The class template PQInternalNode is used to present P-nodes and Q-nodes in the PQ-Tree. More...
|
|
class | PQLeaf |
| The datastructure PQ-tree was designed to present a set of permutations on an arbitrary set of elements. More...
|
|
class | PQLeafKey |
| The class template PQLeafKey is a derived class of class template PQBasicKey. More...
|
|
class | PQNode |
| The class template PQBasicKey is an abstract base class. More...
|
|
class | PQNodeKey |
| The class template PQNodeKey is a derived class of class template PQBasicKey. More...
|
|
class | PQNodeRoot |
| The class PQNodeRoot is used as a base class of the class PQNode. More...
|
|
class | PQTree |
|
class | PreprocessorLayout |
| The PreprocessorLayout removes multi-edges and self-loops. More...
|
|
class | Prioritized |
| Augments any data elements of type X with keys of type Priority. This class is also its own Comparer. More...
|
|
class | PrioritizedMapQueue |
| Prioritized queue interface wrapper for heaps. More...
|
|
class | PrioritizedMapQueue< edge, P, C, Impl, HashFunc > |
| Specialization for edge elements. More...
|
|
class | PrioritizedMapQueue< node, P, C, Impl, HashFunc > |
| Specialization for node elements. More...
|
|
class | PriorityQueue |
| Priority queue interface wrapper for heaps. More...
|
|
class | ProcrustesPointSet |
|
class | ProcrustesSubLayout |
| Simple procrustes analysis. More...
|
|
class | Queue |
| The parameterized class Queue<E> implements list-based queues. More...
|
|
struct | QueueEntry |
|
class | QueuePure |
| Implementation of list-based queues. More...
|
|
class | RadialTreeLayout |
| The radial tree layout algorithm. More...
|
|
class | RadixHeap |
| Radix heap data structure implementation. More...
|
|
class | RadixHeapNode |
|
struct | RandomClusterConfig |
| Parameters for the randomPlanarClustering() method. More...
|
|
class | RandomMerger |
| The random merger for multilevel layout. More...
|
|
class | RandomPlacer |
| The random placer for multilevel layout. More...
|
|
class | RandomVertexPosition |
| Interface for computing a good / optimal vertex position. More...
|
|
class | Range |
| Simple before-C++20 version for std::ranges::ref_view. More...
|
|
class | RankingModule |
| Interface of algorithms for computing a node ranking. More...
|
|
struct | RCCrossings |
|
class | RegisteredArray |
| Dynamic arrays indexed with arbitrary keys. More...
|
|
class | RegisteredArray< Registry, bool, WithDefault, Base > |
| Specialization to work around vector<bool>. More...
|
|
class | RegisteredArrayIterator |
| Iterator for registered arrays. More...
|
|
class | RegisteredMultiArray |
| Data structure for two-dimensional mappings that are sparse in the second dimension. More...
|
|
class | RegisteredSet |
| Constant-time set operations. More...
|
|
class | RegistryBase |
| Abstract base class for registries. More...
|
|
class | Reverse |
| A wrapper class to easily iterate through a container in reverse. More...
|
|
class | RMHeap |
| Randomized meldable heap implementation. More...
|
|
struct | RMHeapNode |
| Randomized meldable heap node. More...
|
|
class | RoutingChannel |
| Maintains input sizes for constructive compaction (size of routing channels, separation, cOverhang) More...
|
|
class | ScalingLayout |
| Scales a graph layout and calls a secondary layout algorithm. More...
|
|
class | SchnyderLayout |
| The class SchnyderLayout represents the layout algorithm by Schnyder [Sch90]. More...
|
|
class | SeparatorDual |
| Computes planar separators using the Dual of the graph. More...
|
|
class | SeparatorDualFC |
| Computes planar separators by applying the Fundamental Cycle Lemma directly, without trying tree levels first. More...
|
|
class | SeparatorHarPeled |
| Computes planar separators according to Har-Peled. More...
|
|
class | SeparatorLiptonTarjan |
| Computes planar separators according to Lipton and Tarjan 1979. More...
|
|
class | SeparatorLiptonTarjanFC |
| Computes planar separators using Fundamental Cycles. More...
|
|
class | ShellingOrder |
| The shelling order of a graph. More...
|
|
class | ShellingOrderModule |
| Base class for modules that compute a shelling order of a graph. More...
|
|
class | ShellingOrderSet |
| The node set in a shelling order of a graph. More...
|
|
class | ShortestPathModule |
|
class | ShortestPathWithBFM |
| Computes single-source shortest-paths with Bellman-Ford-Moore's algorithm. More...
|
|
class | SiftingHeuristic |
| The sifting heuristic for 2-layer crossing minimization. More...
|
|
class | SimDraw |
| The Base class for simultaneous graph drawing. More...
|
|
class | SimDrawCaller |
| Calls modified algorithms for simdraw instances. More...
|
|
class | SimDrawColorizer |
| Adds color to a graph. More...
|
|
class | SimDrawCreator |
| Creates variety of possible SimDraw creations. More...
|
|
class | SimDrawCreatorSimple |
| Offers predefined SimDraw creations. More...
|
|
class | SimDrawManipulatorModule |
| Interface for simdraw manipulators. More...
|
|
class | SimpleCCPacker |
| Splits and packs the components of a Graph. More...
|
|
class | SimpleCluster |
|
class | SimpleEmbedder |
| Embedder that chooses a largest face as the external one. More...
|
|
class | SimpleIncNodeInserter |
|
class | Skeleton |
| Skeleton graphs of nodes in an SPQR-tree. More...
|
|
class | Skiplist |
| A randomized skiplist. More...
|
|
class | SkiplistIterator |
| Forward-Iterator for Skiplists. More...
|
|
class | SList |
| Singly linked lists (maintaining the length of the list). More...
|
|
class | SListElement |
| Structure for elements of singly linked lists. More...
|
|
class | SListIteratorBase |
| Encapsulates a pointer to an ogdf::SList element. More...
|
|
class | SListPure |
| Singly linked lists. More...
|
|
class | SolarMerger |
| The solar merger for multilevel layout. More...
|
|
class | SolarPlacer |
| The solar placer for multilevel layout. More...
|
|
class | SortedSequence |
| Maintains a sequence of (key,info) pairs sorted by key. More...
|
|
class | SortedSequenceIteratorBase |
| Iterators for sorted sequences. More...
|
|
class | SpannerBasicGreedy |
| Multiplicative spanner by greedily adding edges. More...
|
|
class | SpannerBaswanaSen |
| Randomized multiplicative spanner calculation by forming clusters. More...
|
|
class | SpannerBaswanaSenIterated |
| Use the ogdf::SpannerIteratedWrapper to execute the ogdf::SpannerBaswanaSen algorithm up to 1000 times. More...
|
|
class | SpannerBerman |
| Approximation algorithm for calculating spanners. More...
|
|
class | SpannerBermanDisconnected |
| Wrapper around SpannerBerman: For each component of the graph, the algorithm will be called. More...
|
|
class | SpannerElkinNeiman |
| Randomized multiplicative spanner calculation by propagating random messages through the graph. More...
|
|
class | SpannerElkinNeimanIterated |
| Use the ogdf::SpannerIteratedWrapper to execute the ogdf::SpannerElkinNeiman algorithm up to 200 times. More...
|
|
class | SpannerIteratedWrapper |
| A implementation-independed wrapper class to execute a spanner algorithm multiple times. More...
|
|
class | SpannerKortsarzPeleg |
| Approximation multiplicative 2-spanner calculation. More...
|
|
class | SpannerModule |
| Interface for spanner algorithms. More...
|
|
class | SplitHeuristic |
| The split heuristic for 2-layer crossing minimization. More...
|
|
class | SPQRTree |
| Linear-time implementation of static SPQR-trees. More...
|
|
class | SpringEmbedderFRExact |
| Fruchterman-Reingold algorithm with (exact) layout. More...
|
|
class | SpringEmbedderGridVariant |
| The spring-embedder layout algorithm with force approximation using hte grid variant approach. More...
|
|
class | SpringEmbedderKK |
| The spring-embedder layout algorithm by Kamada and Kawai. More...
|
|
class | StarInserter |
|
class | StaticPlanarSPQRTree |
| SPQR-trees of planar graphs. More...
|
|
class | StaticSkeleton |
| Skeleton graphs of nodes in a static SPQR-tree. More...
|
|
class | StaticSPQRTree |
| Linear-time implementation of static SPQR-trees. More...
|
|
class | StdComparer |
| Standard comparer (valid as a static comparer). More...
|
|
class | StdComparer< bool > |
| Generates a specialization of the standard static comparer for booleans. More...
|
|
class | StdComparer< Prioritized< X, Priority > > |
|
class | SteinerTreeLowerBoundDualAscent |
| Implementation of a dual-ascent-based lower bound heuristic for Steiner tree problems. More...
|
|
class | SteinerTreePreprocessing |
| This class implements preprocessing strategies for the Steiner tree problem. More...
|
|
class | StlGreater |
| Template for converting any StdComparer into a STL compatible compare functor. More...
|
|
class | StlLess |
| Template for converting any StdComparer into a STL compatible compare functor. More...
|
|
class | Stopwatch |
| Realizes a stopwatch for measuring elapsed time. More...
|
|
class | StopwatchCPU |
| Implements a stopwatch measuring CPU time. More...
|
|
class | StopwatchWallClock |
| Implements a stopwatch measuring wall-clock time. More...
|
|
class | StressMinimization |
| Energy-based layout using stress minimization. More...
|
|
struct | Stroke |
| Properties of strokes. More...
|
|
class | SubgraphPlanarizer |
| The planarization approach for crossing minimization. More...
|
|
class | SubgraphPlanarizerUML |
| The planarization approach for UML crossing minimization. More...
|
|
class | SubgraphUpwardPlanarizer |
| Takes an acyclic connected non-upward-planar graph and planarizes it, i.e., we obtain an upward-planar graph where crossings are represented via dummy vertices. More...
|
|
class | SubsetEnumerator |
| Enumerator for k-subsets of a given type. More...
|
|
class | SugiyamaLayout |
| Sugiyama's layout algorithm. More...
|
|
class | SvgPrinter |
| SVG Writer. More...
|
|
class | SyncPlanClusterPlanarityModule |
| ClusterPlanarity testing in quadratic time using the Synchronized Planarity approach. More...
|
|
class | System |
| System specific functionality. More...
|
|
class | TargetComparer |
| A static comparer which compares the target of pointers ("content"), instead of the pointer's adresses. More...
|
|
class | Thread |
| Threads supporting OGDF's memory management. More...
|
|
class | TikzWriter |
| LaTeX+TikZ Writer. More...
|
|
class | TileToRowsCCPacker |
| The tile-to-rows algorithm for packing drawings of connected components. More...
|
|
class | Timeouter |
| class for timeout funtionality. More...
|
|
class | TokenIgnorer |
|
class | Top10Heap |
| A variant of BinaryHeapSimple which always holds only the 10 elements with the highest keys. More...
|
|
class | TopologyModule |
| Constructs embeddings from given layout. More...
|
|
class | TreeLayout |
| The tree layout algorithm. More...
|
|
class | TriconnectedShellingOrder |
| Computation of a shelling order for a triconnected and simple (no multi-edges, no self-loops) planar graph. More...
|
|
class | Triconnectivity |
| realizes Hopcroft/Tarjan algorithm for finding the triconnected components of a biconnected multi-graph More...
|
|
class | TsplibXmlParser |
| Parses tsplib files in xml format. More...
|
|
class | Tuple2 |
| Tuples of two elements (2-tuples). More...
|
|
class | TutteLayout |
| Tutte's layout algorithm. More...
|
|
class | TwoLayerCrossMinSimDraw |
|
class | TwoSAT |
| A simple solver for TwoSAT instances, representing the instance as implication graph and solving it via its strongly-connected components. More...
|
|
class | twosat_var |
| In debug mode, twosat_var is a class instead of a simple int to prevent unintened use of the default 0-value instead of TwoSAT_Var_Undefined. More...
|
|
class | TypeNotSupportedException |
| Exception thrown when a data type is not supported by a generic function. More...
|
|
class | UMLCrossingMinimizationModule |
| Base class for UML crossing minimization algorithms. More...
|
|
class | UmlDiagramGraph |
| Contains the class UmlDiagramGraph which represents one particular diagram of the complete UML Model. More...
|
|
class | UMLEdgeInsertionModule |
| Interface for UML edge insertion algorithms. More...
|
|
class | UMLGraph |
|
class | UMLLayoutModule |
| Interface of UML layout algorithms. More...
|
|
class | UmlModelGraph |
| This class represents the complete UML Model in a graph-like data structure. More...
|
|
class | UPRLayoutModule |
| Interface of hierarchy layout algorithms. More...
|
|
class | UpSAT |
|
class | UpwardEdgeInserterModule |
|
class | UpwardPlanarity |
| Upward planarity testing and embedding. More...
|
|
class | UpwardPlanarityEmbeddedDigraph |
|
class | UpwardPlanaritySingleSource |
| Performs upward planarity testing and embedding for single-source digraphs. More...
|
|
class | UpwardPlanarizationLayout |
|
class | UpwardPlanarizerModule |
| Interface for upward planarization algorithms. More...
|
|
class | UpwardPlanarSubgraphModule |
| Interface for algorithms for computing an upward planar subgraph. More...
|
|
class | UpwardPlanarSubgraphSimple |
| A maximal planar subgraph algorithm using planarity testing. More...
|
|
class | UpwardPlanRep |
| Upward planarized representations (of a connected component) of a graph. More...
|
|
struct | UsuallySmallMap |
| A wrapper around std::map that uses a constant-size array (or only a single value) plus linear search until the map grows too big. More...
|
|
class | VarEdgeInserterCore |
|
class | VarEdgeInserterDynCore |
|
class | VarEdgeInserterDynUMLCore |
|
class | VarEdgeInserterUMLCore |
|
class | VariableEmbeddingInserter |
| Optimal edge insertion module. More...
|
|
class | VariableEmbeddingInserterBase |
| Common parameter functionality for ogdf::VariableEmbeddingInserter and ogdf::VariableEmbeddingInserterDyn. More...
|
|
class | VariableEmbeddingInserterDyn |
| Optimal edge insertion module. More...
|
|
class | VariableEmbeddingInserterDynUML |
| Optimal edge insertion module. More...
|
|
class | VariableEmbeddingInserterUML |
| Optimal edge insertion module. More...
|
|
class | VComparer |
| Abstract base class for comparer classes. More...
|
|
class | VertexMovement |
|
class | VertexPositionModule |
| Interface for computing a good / optimal vertex position. More...
|
|
class | VisibilityLayout |
|
class | Voronoi |
| Computes Voronoi regions in an edge-weighted graph. More...
|
|
class | WeightComparer |
|
class | whaInfo |
|
struct | WInfo |
| Saves information about a pertinent node w between two stopping vertices. More...
|
|
class | ZeroPlacer |
| The zero placer for multilevel layout. More...
|
|
class | ZipIterator |
| Simple before-C++20 version for std::ranges::zip_view. More...
|
|
|
using | adjEntry = AdjElement * |
| The type of adjacency entries. More...
|
|
template<typename Value , bool WithDefault = true> |
using | AdjEntryArray = internal::GraphRegisteredArray< AdjElement, Value, WithDefault, internal::GraphAdjRegistry > |
| RegisteredArray for labeling the adjEntries in a Graph with an arbitrary Value . More...
|
|
template<typename Value > |
using | AdjEntryArrayP = AdjEntryArray< std::unique_ptr< Value >, false > |
| Shorthand for AdjEntryArray storing std::unique_ptr<Value>. More...
|
|
template<typename Key2 , typename Value > |
using | AdjEntryMultiArray = RegisteredMultiArray< adjEntry, Key2, Value, internal::AEA > |
|
using | adjHypergraphEntry = AdjHypergraphElement * |
| The type of adjacency entries. More...
|
|
template<class E > |
using | ArrayConstIterator = const E * |
|
template<class E > |
using | ArrayConstReverseIterator = ArrayReverseIteratorBase< E, true > |
|
template<class E > |
using | ArrayIterator = E * |
|
template<class E > |
using | ArrayReverseIterator = ArrayReverseIteratorBase< E, false > |
|
using | cluster = ClusterElement * |
| The type of clusters. More...
|
|
template<typename Value , bool WithDefault = true> |
using | ClusterArray = ClusterArrayBase< Value, WithDefault > |
|
template<typename Value > |
using | ClusterArrayP = ClusterArray< std::unique_ptr< Value >, false > |
| Shorthand for ClusterArray storing std::unique_ptr<Value>. More...
|
|
using | ClusterGraphRegistry = RegistryBase< cluster, ClusterGraph, internal::GraphIterator< cluster > > |
|
using | CombinatorialEmbeddingRegistry = RegistryBase< face, ConstCombinatorialEmbedding, internal::GraphIterator< face > > |
|
using | CrossingMinimalPositionFast = CrossingMinimalPosition< double > |
|
using | DLine = GenericLine< DPoint > |
| Lines with real coordinates. More...
|
|
using | DPoint = GenericPoint< double > |
| Representing two-dimensional point with real coordinates. More...
|
|
using | DPolyline = GenericPolyline< DPoint > |
| Polylines with DPoint points. More...
|
|
using | DSegment = GenericSegment< DPoint > |
| Segments with real coordinates. More...
|
|
using | DualGraph = DualGraphBase< true > |
|
using | DynamicDualGraph = DualGraphBase< false > |
|
using | edge = EdgeElement * |
| The type of edges. More...
|
|
template<typename Value , bool WithDefault = true> |
using | EdgeArray = internal::EdgeArrayBase2< Value, WithDefault > |
| RegisteredArray for labeling the edges in a Graph with an arbitrary Value . More...
|
|
template<typename Value > |
using | EdgeArrayP = EdgeArray< std::unique_ptr< Value >, false > |
| Shorthand for EdgeArray storing std::unique_ptr<Value>. More...
|
|
template<typename Key2 , typename Value > |
using | EdgeMultiArray = RegisteredMultiArray< edge, Key2, Value, internal::EA > |
|
using | edgeType = long long |
|
using | face = FaceElement * |
|
template<typename Value , bool WithDefault = true> |
using | FaceArray = FaceArrayBase< Value, WithDefault > |
|
template<typename Value > |
using | FaceArrayP = FaceArray< std::unique_ptr< Value >, false > |
| Shorthand for FaceArray storing std::unique_ptr<Value>. More...
|
|
using | hyperedge = HyperedgeElement * |
| The type of hyperedges. More...
|
|
template<typename Value , bool WithDefault = true> |
using | HyperedgeArray = HypergraphRegisteredArray< HyperedgeElement, Value, WithDefault > |
| Array for labeling the hyperedges in a Hypergraph with an arbitrary Value . More...
|
|
template<typename Value > |
using | HyperedgeArrayP = HyperedgeArray< std::unique_ptr< Value >, false > |
| Shorthand for HyperedgeArray storing std::unique_ptr<Value>. More...
|
|
using | hypernode = HypernodeElement * |
| The type of hypernodes. More...
|
|
template<typename Value , bool WithDefault = true> |
using | HypernodeArray = HypergraphRegisteredArray< HypernodeElement, Value, WithDefault > |
| Array for labeling the hypernodes in a Hypergraph with an arbitrary Value . More...
|
|
template<typename Value > |
using | HypernodeArrayP = HypernodeArray< std::unique_ptr< Value >, false > |
| Shorthand for HypernodeArray storing std::unique_ptr<Value>. More...
|
|
using | IPoint = GenericPoint< int > |
| Representing a two-dimensional point with integer coordinates. More...
|
|
using | IPolyline = GenericPolyline< IPoint > |
| Polylines with IPoint points. More...
|
|
template<class E > |
using | ListConstIterator = ListIteratorBase< E, true, false > |
|
template<class E > |
using | ListConstReverseIterator = ListIteratorBase< E, true, true > |
|
template<class E > |
using | ListIterator = ListIteratorBase< E, false, false > |
|
template<class E > |
using | ListReverseIterator = ListIteratorBase< E, false, true > |
|
using | node = NodeElement * |
| The type of nodes. More...
|
|
template<typename Value , bool WithDefault = true> |
using | NodeArray = internal::GraphRegisteredArray< NodeElement, Value, WithDefault > |
| RegisteredArray for labeling the nodes in a Graph with an arbitrary Value . More...
|
|
template<typename Value > |
using | NodeArrayP = NodeArray< std::unique_ptr< Value >, false > |
| Shorthand for NodeArray storing std::unique_ptr<Value>. More...
|
|
template<typename Key2 , typename Value > |
using | NodeMultiArray = RegisteredMultiArray< node, Key2, Value, internal::NA > |
|
using | nodeType = long long |
|
using | pa_label = PALabel * |
|
using | PredecessorMap = std::unordered_map< node, std::unique_ptr< NodeArray< edge > >> |
|
template<typename E , typename P , class C = std::less<P>, template< typename, class > class Impl = PairingHeap> |
using | PrioritizedQueue = pq_internal::PrioritizedQueue< E, P, C, Impl > |
| Prioritized queue interface wrapper for heaps. More...
|
|
template<class E > |
using | SListConstIterator = SListIteratorBase< E, true > |
|
template<class E > |
using | SListIterator = SListIteratorBase< E, false > |
|
template<class KEY , class INFO , class CMP > |
using | SortedSequenceConstIterator = SortedSequenceIteratorBase< KEY, INFO, CMP, true, false > |
|
template<class KEY , class INFO , class CMP > |
using | SortedSequenceConstReverseIterator = SortedSequenceIteratorBase< KEY, INFO, CMP, true, true > |
|
template<class KEY , class INFO , class CMP > |
using | SortedSequenceIterator = SortedSequenceIteratorBase< KEY, INFO, CMP, false, false > |
|
template<class KEY , class INFO , class CMP > |
using | SortedSequenceReverseIterator = SortedSequenceIteratorBase< KEY, INFO, CMP, false, true > |
|
|
void | assertStarCentreAndRay (node centre, node ray) |
| Check that one vertex is the centre of star while the other is one of its rays. More...
|
|
HypergraphRegistry< HyperedgeElement >::iterator | begin (const HypergraphRegistry< HyperedgeElement > &self) |
|
HypergraphRegistry< HypernodeElement >::iterator | begin (const HypergraphRegistry< HypernodeElement > &self) |
|
void | bendEdge (GraphAttributes &GA, edge e, double bend) |
| Add a bendpoint to the middle of an edges that is shifted orthogonally by a certain fraction of the edge's length. More...
|
|
template<typename TCost > |
void | bfs_SPAP (const Graph &G, NodeArray< NodeArray< TCost >> &distance, TCost edgeCosts) |
| Computes all-pairs shortest paths in G using breadth-first serach (BFS). More...
|
|
template<typename TCost > |
void | bfs_SPSS (node s, const Graph &G, NodeArray< TCost > &distanceArray, TCost edgeCosts) |
| Computes single-source shortest paths from s in G using breadth-first search (BFS). More...
|
|
template<class E > |
void | bucketSort (Array< E > &a, int min, int max, BucketFunc< E > &f) |
| Bucket-sort array a using bucket assignment f ; the values of f must be in the interval [min ,max ]. More...
|
|
int | calculateTableSize (int actualCount) |
| The default growth function for registered arrays. More...
|
|
template<typename CONTAINER , typename TYPE > |
CONTAINER::const_iterator | chooseIteratorFrom (const CONTAINER &container, std::function< bool(const TYPE &)> includeElement=[](const TYPE &) { return true;}, bool isFastTest=true) |
| Returns an iterator to a random element in the container . More...
|
|
template<typename CONTAINER , typename TYPE > |
CONTAINER::iterator | chooseIteratorFrom (CONTAINER &container, std::function< bool(const TYPE &)> includeElement=[](const TYPE &) { return true;}, bool isFastTest=true) |
| Returns an iterator to a random element in the container . More...
|
|
OrderComp | compareCyclicOrder (node n, List< adjEntry > &o, bool full_check=false) |
| Cyclically compare the rotation of a node with a given cyclic order. More...
|
|
int | computeSTNumbering (const Graph &G, NodeArray< int > &numbering, node s=nullptr, node t=nullptr, bool randomized=false) |
| Computes an st-Numbering of G . More...
|
|
DPoint | contourPointFromAngle (double angle, int n, double rotationOffset=0, const DPoint ¢er=DPoint(), const DPoint &vSize=DPoint(1, 1)) |
| returns the point where a vector, pointing from center in direction of angle, intersects with the contour of any regular n-polygon. More...
|
|
DPoint | contourPointFromAngle (double angle, Shape shape, const DPoint ¢er=DPoint(), const DPoint &vSize=DPoint(1, 1)) |
| returns the point where a vector, pointing from center in direction of angle, intersects with the contour of any Shape. More...
|
|
void | copyEmbedding (const Graph &from, Graph &to, std::function< adjEntry(adjEntry)> adjMapFromTo) |
|
void | degreeDistribution (const Graph &G, Array< int > °dist) |
| Fills degdist with the degree distribution of graph G . More...
|
|
bool | dfsGenTree (UMLGraph &UG, List< edge > &fakedGens, bool fakeTree) |
|
bool | dfsGenTreeRec (UMLGraph &UG, EdgeArray< bool > &used, NodeArray< int > &hierNumber, int hierNum, node v, List< edge > &fakedGens, bool fakeTree) |
|
template<typename TCost > |
void | dijkstra_SPAP (const Graph &G, NodeArray< NodeArray< TCost >> &shortestPathMatrix, const EdgeArray< TCost > &edgeCosts) |
| Computes all-pairs shortest paths in graph G using Dijkstra's algorithm. More...
|
|
template<typename TCost > |
double | dijkstra_SPAP (const GraphAttributes &GA, NodeArray< NodeArray< TCost >> &shortestPathMatrix) |
| Computes all-pairs shortest paths in GA using Dijkstra's algorithm. More...
|
|
template<typename TCost > |
void | dijkstra_SPSS (node s, const Graph &G, NodeArray< TCost > &shortestPathMatrix, const EdgeArray< TCost > &edgeCosts) |
| Computes single-source shortest paths from node s in G using Disjkstra's algorithm. More...
|
|
HypergraphRegistry< HyperedgeElement >::iterator | end (const HypergraphRegistry< HyperedgeElement > &self) |
|
HypergraphRegistry< HypernodeElement >::iterator | end (const HypergraphRegistry< HypernodeElement > &self) |
|
bool | equalIgnoreCase (const string &str1, const string &str2) |
| Compares the two strings str1 and str2 , ignoring the case of characters. More...
|
|
bool | filter_any_edge (edge e) |
| std::function<bool(edge)> that returns true for any edge e More...
|
|
bool | filter_any_node (node n) |
| std::function<bool(node)> that returns true for any node n More...
|
|
edge | firstOutGen (UMLGraph &UG, node v, EdgeArray< bool > &) |
|
void | fixLoops (Graph &G, const std::function< void(edge, edge)> &cb) |
| Safely call a function on all self-loops to, e.g., subdivide or remove them. More...
|
|
void | fixParallels (Graph &G, const std::function< void(edge, edge)> &cb) |
| Safely call a function on all parallel edges to, e.g., subdivide or remove them. More...
|
|
template<typename TCost > |
void | floydWarshall_SPAP (NodeArray< NodeArray< TCost >> &shortestPathMatrix, const Graph &G) |
| Computes all-pairs shortest paths in graph G using Floyd-Warshall's algorithm. More...
|
|
template<class ToClass > |
ToClass | fromString (string key) |
|
node | getCentreOfStar (node g_n) |
| Given a vertex that is either the centre or ray of a star, return the centre of the respective star. More...
|
|
template<class NODELISTITERATOR , class EDGELIST > |
void | inducedSubgraph (Graph &G, NODELISTITERATOR &it, EDGELIST &E) |
| Computes the edges in a node-induced subgraph. More...
|
|
void | initFillPatternHashing () |
|
void | insertAugmentationEdges (const ClusterGraph &CG, Graph &G, std::vector< std::pair< adjEntry, adjEntry >> &augmentation, EdgeSet<> *added=nullptr, bool embedded=true, bool assert_minimal=true) |
| Inserts augmentation edges to make a c-plane graph c-connected while maintaining the combinatorial embedding. More...
|
|
FillPattern | intToFillPattern (int i) |
| Converts integer i to fill pattern. More...
|
|
StrokeType | intToStrokeType (int i) |
| Converts integer i to stroke type. More...
|
|
bool | isBipartite (const Graph &G) |
| Checks whether a graph is bipartite. More...
|
|
bool | isBipartite (const Graph &G, NodeArray< bool > &color) |
| Checks whether a graph is bipartite. More...
|
|
template<typename T > |
bool | isinf (T value) |
|
bool | isPlanar (const Graph &G) |
| Returns true, if G is planar, false otherwise. More...
|
|
bool | isPointCoveredByNode (const DPoint &point, const DPoint &v, const DPoint &vSize, const Shape &shape) |
| Check whether this point lies within a node (using node shapes with same size and aspect as in TikZ). More...
|
|
bool | isRegular (const Graph &G) |
| Checks if a graph is regular. More...
|
|
bool | isRegular (const Graph &G, int d) |
| Checks if a graph is d-regular. More...
|
|
bool | isSTNumbering (const Graph &G, NodeArray< int > &st_no, int max) |
| Tests, whether a numbering of the nodes is an st-numbering. More...
|
|
bool | isSTPlanar (const Graph &graph, const node s, const node t) |
| Returns whether G is s-t-planar (i.e. More...
|
|
bool | joinEdge (Graph &G, adjEntry u_adj, adjEntry v_adj, node u, node v) |
| Join two edges into one, keeping the two endpoints corresponding to the adjEntries. More...
|
|
bool | joinEdge (Graph &G, adjEntry u_adj, adjEntry v_adj, node u, node v, const std::function< void(edge)> &deleteEdge) |
| Join two edges into one, keeping the two endpoints corresponding to the adjEntries and using a custom function for deleting the old edge. More...
|
|
bool | joinEdge (Graph &G, edge u_e, edge v_e, node u, node v) |
| Join two edges into one, keeping the two given endpoints. More...
|
|
bool | joinEdge (Graph &G, edge u_e, edge v_e, node u, node v, const std::function< void(edge)> &deleteEdge) |
| Join two edges into one, keeping the two given endpoints and using a custom function for deleting the old edge. More...
|
|
bool | maximumDensitySubgraph (Graph &G, NodeSet< true > &subgraphNodes, std::function< node(node)> resultNodeMap=[](node v) { return v;}, int64_t timelimit=-1) |
| Calculates the maximum density subgraph of G . More...
|
|
void | moveAdjToBack (Graph &G, adjEntry b) |
| Rotate a node to move a given adjEntry to the back of its list. More...
|
|
void | moveAdjToFront (Graph &G, adjEntry f) |
| Rotate a node to move a given adjEntry to the front of its list. More...
|
|
void | moveEnd (Graph &G, adjEntry keep_adj, adjEntry new_adj, Direction dir=Direction::after) |
| Change one endpoint of an edge observing a certain embedding, no matter its direction. More...
|
|
void | moveEnd (Graph &G, edge e, node keep_end, node new_end) |
| Change one endpoint of an edge, no matter its direction. More...
|
|
void | nodeDistribution (const Graph &G, Array< int > °dist, std::function< int(node)> func) |
| Fills dist with the distribution given by a function func in graph G . More...
|
|
template<class E1 , class E2 > |
bool | operator!= (const Tuple2< E1, E2 > &t1, const Tuple2< E1, E2 > &t2) |
| Inequality operator for 2-tuples. More...
|
|
bool | operator!= (int lhs, BoyerMyrvoldPlanar::EmbeddingGrade rhs) |
|
edgeType | operator& (edgeType lhs, UMLEdgeTypeConstants rhs) |
|
edgeType | operator& (edgeType lhs, UMLEdgeTypePatterns rhs) |
|
int | operator& (int i, TopologyModule::Options b) |
|
int | operator& (int lhs, UMLOpt rhs) |
|
int | operator& (int lhs, WInfo::MinorType rhs) |
|
edgeType | operator& (UMLEdgeTypePatterns lhs, edgeType rhs) |
|
int | operator+= (int &lhs, UMLOpt rhs) |
|
edgeType | operator<< (edgeType lhs, UMLEdgeTypeOffsets rhs) |
|
edgeType | operator<< (edgeType lhs, UMLEdgeTypePatterns rhs) |
|
std::ostream & | operator<< (std::ostream &os, cluster c) |
|
std::ostream & | operator<< (std::ostream &os, Configuration::LPSolver lps) |
| Output operator for Configuration::LPSolver (uses Configuration::toString(Configuration::LPSolver)). More...
|
|
std::ostream & | operator<< (std::ostream &os, Configuration::MemoryManager mm) |
| Output operator for Configuration::MemoryManager (uses Configuration::toString(Configuration::MemoryManager)). More...
|
|
std::ostream & | operator<< (std::ostream &os, Configuration::System sys) |
| Output operator for Configuration::System (uses Configuration::toString(Configuration::System)). More...
|
|
std::ostream & | operator<< (std::ostream &os, const BalloonLayout::RootSelection &rs) |
|
std::ostream & | operator<< (std::ostream &os, const BCTree::BNodeType &obj) |
|
std::ostream & | operator<< (std::ostream &os, const BCTree::GNodeType &obj) |
|
template<class E , class INDEX > |
std::ostream & | operator<< (std::ostream &os, const BoundedQueue< E, INDEX > &Q) |
| Prints BoundedQueue Q to output stream os . More...
|
|
std::ostream & | operator<< (std::ostream &os, const DPolygon &dop) |
| Output operator for polygons. More...
|
|
std::ostream & | operator<< (std::ostream &os, const EdgeArrow &ea) |
| Output operator. More...
|
|
std::ostream & | operator<< (std::ostream &os, const FillPattern &fp) |
| Output operator. More...
|
|
template<class PointType > |
std::ostream & | operator<< (std::ostream &os, const GenericLine< PointType > &line) |
| Output operator for lines. More...
|
|
template<typename T > |
std::ostream & | operator<< (std::ostream &os, const GenericPoint< T > &p) |
| Output operator for generic points. More...
|
|
template<class PointType > |
std::ostream & | operator<< (std::ostream &os, const GenericSegment< PointType > &dl) |
| Output operator for line segments. More...
|
|
std::ostream & | operator<< (std::ostream &os, const Graph::EdgeType &et) |
|
std::ostream & | operator<< (std::ostream &os, const KuratowskiWrapper::SubdivisionType &obj) |
|
template<class E > |
std::ostream & | operator<< (std::ostream &os, const List< E > &L) |
| Prints list L to output stream os . More...
|
|
template<class E > |
std::ostream & | operator<< (std::ostream &os, const ListPure< E > &L) |
| Prints list L to output stream os . More...
|
|
std::ostream & | operator<< (std::ostream &os, const Module::ReturnType &r) |
|
std::ostream & | operator<< (std::ostream &os, const NodePair &np) |
|
template<class E , class INDEX > |
std::ostream & | operator<< (std::ostream &os, const ogdf::Array< E, INDEX > &a) |
| Prints array a to output stream os . More...
|
|
template<class E , class INDEX > |
std::ostream & | operator<< (std::ostream &os, const ogdf::ArrayBuffer< E, INDEX > &a) |
| Prints ArrayBuffer a to output stream os . More...
|
|
template<class E > |
std::ostream & | operator<< (std::ostream &os, const Queue< E > &Q) |
|
template<class E > |
std::ostream & | operator<< (std::ostream &os, const QueuePure< E > &Q) |
|
std::ostream & | operator<< (std::ostream &os, const RCCrossings &cr) |
|
std::ostream & | operator<< (std::ostream &os, const Shape &shape) |
| Output operator. More...
|
|
template<class E > |
std::ostream & | operator<< (std::ostream &os, const SList< E > &L) |
| Output operator. More...
|
|
template<class E > |
std::ostream & | operator<< (std::ostream &os, const SListPure< E > &L) |
| Output operator. More...
|
|
std::ostream & | operator<< (std::ostream &os, const StrokeType &st) |
| Output operator. More...
|
|
template<class T > |
std::ostream & | operator<< (std::ostream &os, const SubsetEnumerator< T > &subset) |
|
template<class E1 , class E2 > |
std::ostream & | operator<< (std::ostream &os, const Tuple2< E1, E2 > &t2) |
| Output operator for 2-tuples. More...
|
|
std::ostream & | operator<< (std::ostream &os, const UmlModelGraph &modelGraph) |
| Output operator for UmlModelGraph. More...
|
|
std::ostream & | operator<< (std::ostream &os, DynamicSPQRForest::TNodeType t) |
|
std::ostream & | operator<< (std::ostream &os, Logger::Level level) |
|
std::ostream & | operator<< (std::ostream &os, ogdf::adjEntry adj) |
| Output operator for adjacency entries; prints node and twin indices (or "nil"). More...
|
|
std::ostream & | operator<< (std::ostream &os, ogdf::edge e) |
| Output operator for edges; prints source and target indices (or "nil"). More...
|
|
std::ostream & | operator<< (std::ostream &os, ogdf::face f) |
| Output operator for faces; prints face index (or "nil"). More...
|
|
std::ostream & | operator<< (std::ostream &os, ogdf::node v) |
| Output operator for nodes; prints node index (or "nil"). More...
|
|
std::ostream & | operator<< (std::ostream &os, Triconnectivity::CompType type) |
|
edgeType | operator<< (UMLEdgeTypeConstants lhs, UMLEdgeTypeOffsets rhs) |
|
int | operator<< (UMLNodeTypeConstants lhs, UMLNodeTypeOffsets rhs) |
|
bool | operator<= (int lhs, BoyerMyrvoldPlanar::EmbeddingGrade rhs) |
|
template<class E1 , class E2 > |
bool | operator== (const Tuple2< E1, E2 > &t1, const Tuple2< E1, E2 > &t2) |
| Equality operator for 2-tuples. More...
|
|
bool | operator== (edgeType lhs, UMLEdgeTypeConstants rhs) |
|
bool | operator== (int lhs, BoyerMyrvoldPlanar::EmbeddingGrade rhs) |
|
bool | operator> (int lhs, BoyerMyrvoldPlanar::EmbeddingGrade rhs) |
|
edgeType | operator>> (edgeType lhs, UMLEdgeTypeOffsets rhs) |
|
std::istream & | operator>> (std::istream &is, TokenIgnorer token) |
|
int | operator| (int i, TopologyModule::Options b) |
|
int | operator| (int lhs, UMLOpt rhs) |
|
int | operator| (TopologyModule::Options a, TopologyModule::Options b) |
|
int | operator|= (int &lhs, WInfo::MinorType rhs) |
|
unsigned int | operator|= (unsigned int &i, CPUFeatureMask fm) |
|
int | operator~ (UMLOpt rhs) |
|
int | orientation (const DPoint &p, const DPoint &q, const DPoint &r) |
|
int | orientation (const DSegment &s, const DPoint &p) |
|
bool | planarEmbed (Graph &G) |
| Returns true, if G is planar, false otherwise. If true is returned, G will be planarly embedded. More...
|
|
bool | planarEmbedPlanarGraph (Graph &G) |
| Constructs a planar embedding of G. It assumes that G is planar! More...
|
|
void | planarizeClusterBorderCrossings (const ClusterGraph &CG, Graph &G, EdgeArray< List< std::pair< adjEntry, cluster >>> *subdivisions, const std::function< edge(edge)> &translate) |
| Turn cluster borders into cycles of edges and cluster-border-edge-crossings into vertices. More...
|
|
bool | planarSTEmbed (Graph &graph, node s, node t) |
| s-t-planarly embeds a graph. More...
|
|
bool | prefixIgnoreCase (const string &prefix, const string &str) |
| Tests if prefix is a prefix of str , ignoring the case of characters. More...
|
|
template<class E , class INDEX > |
void | print (std::ostream &os, const Array< E, INDEX > &a, char delim=' ') |
| Prints array a to output stream os using delimiter delim . More...
|
|
template<class E , class INDEX > |
void | print (std::ostream &os, const ArrayBuffer< E, INDEX > &a, char delim=' ') |
| Prints ArrayBuffer a to output stream os using delimiter delim . More...
|
|
template<class E > |
void | print (std::ostream &os, const List< E > &L, char delim=' ') |
| Prints list L to output stream os using delimiter delim . More...
|
|
template<class E > |
void | print (std::ostream &os, const ListPure< E > &L, char delim=' ') |
| Prints list L to output stream os using delimiter delim . More...
|
|
template<class E > |
void | print (std::ostream &os, const Queue< E > &Q, char delim=' ') |
|
template<class E > |
void | print (std::ostream &os, const QueuePure< E > &Q, char delim=' ') |
|
template<class E > |
void | print (std::ostream &os, const SList< E > &L, char delim=' ') |
| Prints list L to output stream os using delimiter delim . More...
|
|
template<class E > |
void | print (std::ostream &os, const SListPure< E > &L, char delim=' ') |
| Prints list L to output stream os using delimiter delim . More...
|
|
template<class LIST > |
void | quicksortTemplate (LIST &L) |
|
template<class LIST , class COMPARER > |
void | quicksortTemplate (LIST &L, const COMPARER &comp) |
|
double | randomDouble (double low, double high) |
| Returns a random double value from the interval [low , high ). More...
|
|
double | randomDoubleExponential (double beta) |
| Returns a random double value from the exponential distribution. More...
|
|
double | randomDoubleNormal (double m, double sd) |
| Returns a random double value from the normal distribution with mean m and standard deviation sd. More...
|
|
int | randomNumber (int low, int high) |
| Returns random integer between low and high (including). More...
|
|
long unsigned int | randomSeed () |
| Returns a random value suitable as initial seed for a random number engine. More...
|
|
void | reduceLevelPlanarityToClusterPlanarity (const Graph &LG, const std::vector< std::vector< node >> &emb, Graph &G, ClusterGraph &CG, EdgeArray< node > &embMap) |
| Perform the reduction from level- to cluster planarity. More...
|
|
void | removeTrailingWhitespace (string &str) |
| Removes trailing space, horizontal and vertical tab, feed, newline, and carriage return from str . More...
|
|
template<typename T > |
Reverse< T > | reverse (T &container) |
| Provides iterators for container to make it easily iterable in reverse. More...
|
|
template<typename CONTAINER > |
void | safeForEach (CONTAINER &container, std::function< void(typename CONTAINER::value_type)> func) |
| Calls (possibly destructive) func for each element of container . More...
|
|
template<typename CONTAINER > |
bool | safeTestForEach (CONTAINER &container, std::function< bool(typename CONTAINER::value_type)> func) |
| Like ogdf::safeForEach() but aborts if func returns false . More...
|
|
template<typename CONTAINER , typename T > |
int | searchPos (const CONTAINER &C, const T &x) |
| Searches for the position of x in container C ; returns -1 if not found. More...
|
|
void | setSeed (int val) |
| Sets the seed for functions like randomSeed(), randomNumber(), randomDouble(). More...
|
|
adjEntry | splitEdge (Graph &G, adjEntry adj, node new_adj_to_node, node new_adj_to_twin, edge new_edge=nullptr) |
| Split an edge, moving the two new middle endpoints to some other vertices observing a certain embedding. More...
|
|
edge | splitEdge (Graph &G, edge old_edge, node new_adj_to_source, node new_adj_to_target, edge new_edge=nullptr) |
| Split an edge, moving the two new middle endpoints to some other vertices. More...
|
|
void | spreadParallels (GraphAttributes &GA, double min_spread=0.1, double max_spread=0.6, double max_abs=100) |
| A bends to parallel edges to make them distinguishable. More...
|
|
template<typename E > |
static E | toEnum (const std::string &str, std::string toString(const E &), const E first, const E last, const E def) |
|
template<class FromClass > |
string | toString (FromClass key) |
|
const twosat_var | TwoSAT_Var_Undefined (-1) |
|
double | usedTime (double &T) |
| Returns used CPU time from T to current time and assigns current time to T. More...
|
|