All Classes Interface Summary Class Summary Enum Summary Exception Summary
Class |
Description |
AbstractBaseGraph<V,E> |
The most general implementation of the Graph interface.
|
AbstractGraph<V,E> |
A skeletal implementation of the Graph interface, to minimize the effort required to
implement graph interfaces.
|
AbstractGraphBuilder<V,E,G extends Graph<V,E>,B extends AbstractGraphBuilder<V,E,G,B>> |
Base class for builders of Graph
|
AbstractGraphIterator<V,E> |
An empty implementation of a graph iterator to minimize the effort required to implement graph
iterators.
|
AbstractGraphIterator.DirectedSpecifics<VV,EE> |
|
AbstractGraphIterator.FlyweightEdgeEvent<VV,localE> |
A reusable edge event.
|
AbstractGraphIterator.FlyweightVertexEvent<VV> |
A reusable vertex event.
|
AbstractGraphIterator.Specifics<VV,EE> |
Provides unified interface for operations that are different in directed graphs and in
undirected graphs.
|
AbstractGraphIterator.UndirectedSpecifics<VV,EE> |
|
AbstractPathElement<V,E> |
Deprecated.
|
AbstractPathElement<V,E> |
A new path is created from a path concatenated to an edge.
|
AbstractPathElementList<V,E,T extends AbstractPathElement<V,E>> |
Deprecated.
|
AbstractPathElementList<V,E,T extends AbstractPathElement<V,E>> |
List of paths AbstractPathElement with same target vertex.
|
AllDirectedPaths<V,E> |
Deprecated.
|
AllDirectedPaths<V,E> |
A Dijkstra-like algorithm to find all paths between two sets of nodes in a directed graph, with
options to search only simple paths and to limit the path length.
|
ALTAdmissibleHeuristic<V,E> |
An admissible heuristic for the A* algorithm using a set of landmarks and the triangle
inequality.
|
AlwaysEqualComparator<T> |
A default implementation for a check on equality (that always holds)
|
ApproximationAlgorithm<ResultType,V> |
An interface for an approximation algorithm.
|
ArrayUnenforcedSet<E> |
Helper for efficiently representing small sets whose elements are known to be unique by
construction, implying we don't need to enforce the uniqueness property in the data structure
itself.
|
ArrayUnenforcedSetEdgeSetFactory<V,E> |
An edge set factory which creates ArrayUnenforcedSet of size 1, suitable for small degree
vertices.
|
AStarAdmissibleHeuristic<V> |
Interface for an admissible heuristic used in A* search.
|
AStarShortestPath<V,E> |
Deprecated.
|
AStarShortestPath<V,E> |
A* shortest path.
|
AsUndirectedGraph<V,E> |
An undirected view of the backing directed graph specified in the constructor.
|
AsUnweightedDirectedGraph<V,E> |
An unweighted view of the backing weighted graph specified in the constructor.
|
AsUnweightedGraph<V,E> |
An unweighted view of the backing weighted graph specified in the constructor.
|
AsWeightedDirectedGraph<V,E> |
A weighted view of the backing graph specified in the constructor.
|
AsWeightedGraph<V,E> |
A weighted view of the backing graph specified in the constructor.
|
BarYehudaEvenTwoApproxVCImpl<V,E> |
Implementation of the 2-opt algorithm for a minimum weighted vertex cover by R.
|
BaseShortestPathAlgorithm<V,E> |
A base implementation of the shortest path interface.
|
BellmanFordIterator<V,E> |
Deprecated.
|
BellmanFordIterator<V,E> |
|
BellmanFordPathElement<V,E> |
Deprecated.
|
BellmanFordPathElement<V,E> |
|
BellmanFordShortestPath<V,E> |
Deprecated.
|
BellmanFordShortestPath<V,E> |
|
BiconnectivityInspector<V,E> |
Inspects a graph for the biconnectivity property.
|
BidirectionalDijkstraShortestPath<V,E> |
Deprecated.
|
BidirectionalDijkstraShortestPath<V,E> |
A bidirectional version of Dijkstra's algorithm.
|
BlockCutpointGraph<V,E> |
|
BoruvkaMinimumSpanningTree<V,E> |
Borůvka's algorithm for the computation of a minimum spanning tree.
|
BreadthFirstIterator<V,E> |
A breadth-first iterator for a directed and an undirected graph.
|
BronKerboschCliqueFinder<V,E> |
This class implements Bron-Kerbosch clique detection algorithm as it is described in [Samudrala
R.,Moult J.:A Graph-theoretic Algorithm for comparative Modeling of Protein Structure; J.Mol.
|
BrownBacktrackColoring<V,E> |
Brown graph coloring algorithm.
|
ChromaticNumber |
|
ClarksonTwoApproxVCImpl<V,E> |
Implementation of the 2-opt algorithm for a minimum weighted vertex cover by Clarkson, Kenneth L.
|
ClassBasedEdgeFactory<V,E> |
An EdgeFactory for producing edges by using a class as a factory.
|
ClassBasedVertexFactory<V> |
A VertexFactory for producing vertices by using a class as a factory.
|
CliqueMinimalSeparatorDecomposition<V,E> |
Clique Minimal Separator Decomposition using MCS-M+ and Atoms algorithm as described in Berry et
al.
|
ClosestFirstIterator<V,E> |
A closest-first iterator for a directed or undirected graph.
|
ClosestFirstIterator.QueueEntry<V,E> |
Private data to associate with each entry in the priority queue.
|
CompleteBipartiteGraphGenerator<V,E> |
|
CompleteGraphGenerator<V,E> |
Generates a complete graph of any size.
|
ConnectedComponentTraversalEvent |
A traversal event with respect to a connected component.
|
ConnectivityInspector<V,E> |
Allows obtaining various connectivity aspects of a graph.
|
CrossComponentIterator<V,E,D> |
Provides a cross-connected-component traversal functionality for iterator subclasses.
|
CrossComponentIterator.SimpleContainer<T> |
|
CrossComponentIterator.VisitColor |
Standard vertex visit state enumeration.
|
CycleDetector<V,E> |
Performs cycle detection on a graph.
|
CycleDetector.CycleDetectedException |
Exception thrown internally when a cycle is detected during a yes/no cycle test.
|
DefaultDirectedGraph<V,E> |
A directed graph.
|
DefaultDirectedWeightedGraph<V,E> |
A directed weighted graph.
|
DefaultEdge |
A default implementation for edges in a Graph .
|
DefaultGraphMapping<V,E> |
Implementation of the GraphMapping interface.
|
DefaultListenableGraph<V,E> |
A graph backed by the the graph specified at the constructor, which can be listened by
GraphListener s and by
VertexSetListener s.
|
DefaultListenableGraph.FlyweightEdgeEvent<VV,EE> |
A reuseable edge event.
|
DefaultListenableGraph.FlyweightVertexEvent<VV> |
A reuseable vertex event.
|
DefaultWeightedEdge |
|
DepthFirstIterator<V,E> |
A depth-first iterator for a directed and an undirected graph.
|
DijkstraClosestFirstIterator<V,E> |
A light-weight version of the closest-first iterator for a directed or undirected graphs.
|
DijkstraShortestPath<V,E> |
Deprecated.
|
DijkstraShortestPath<V,E> |
|
DirectedAcyclicGraph<V,E> |
DirectedAcyclicGraph implements a DAG that can be modified (vertices & edges added and
removed), is guaranteed to remain acyclic, and provides fast topological order iteration.
|
DirectedAcyclicGraph.CycleFoundException |
Exception used in dfsF when a cycle is found
|
DirectedAcyclicGraph.Region |
Region is an *inclusive* range of indices.
|
DirectedAcyclicGraph.TopoComparator<V> |
Note, this is a lazy and incomplete implementation, with assumptions that inputs are in the
given topoIndexMap
|
DirectedAcyclicGraph.TopoOrderMapping<V> |
For performance tuning, an interface for storing the topological ordering
|
DirectedAcyclicGraph.TopoOrderMappingFactory<V> |
|
DirectedAcyclicGraph.Visited |
This interface allows specification of a strategy for marking vertices as visited (based on
their topological index, so the vertex type isn't part of the interface).
|
DirectedAcyclicGraph.VisitedArrayImpl |
This implementation, somewhat to my surprise, is slower than the ArrayList version, probably
due to its reallocation of the underlying array for every topology reorder that is required.
|
DirectedAcyclicGraph.VisitedArrayListImpl |
This implementation seems to offer the best performance in most cases.
|
DirectedAcyclicGraph.VisitedBitSetImpl |
This implementation is close to the performance of VisitedArrayListImpl, with 1/8 the memory
usage.
|
DirectedAcyclicGraph.VisitedFactory |
Interface for a factory that vends visited implementations
|
DirectedAcyclicGraph.VisitedHashSetImpl |
This implementation doesn't seem to perform as well, though I can imagine circumstances where
it should shine (lots and lots of vertices).
|
DirectedEdgeContainer<V,E> |
A container for vertex edges.
|
DirectedGraph<V,E> |
A graph whose all edges are directed.
|
DirectedGraphBuilder<V,E,G extends DirectedGraph<V,E>> |
A builder class for Graph .
|
DirectedGraphBuilderBase<V,E,G extends DirectedGraph<V,E>,B extends DirectedGraphBuilderBase<V,E,G,B>> |
|
DirectedGraphUnion<V,E> |
A union of directed graphs.
|
DirectedMaskSubgraph<V,E> |
|
DirectedMultigraph<V,E> |
A directed multigraph.
|
DirectedNeighborIndex<V,E> |
Maintains a cache of each vertex's neighbors.
|
DirectedPseudograph<V,E> |
A directed pseudograph.
|
DirectedSimpleCycles<V,E> |
A common interface for classes implementing algorithms for enumeration of the simple cycles of a
directed graph.
|
DirectedSpecifics<V,E> |
Plain implementation of DirectedSpecifics.
|
DirectedSubgraph<V,E> |
A directed graph that is a subgraph of another graph.
|
DirectedWeightedGraphBuilder<V,E,G extends DirectedGraph<V,E> & WeightedGraph<V,E>> |
A builder class for directed weighted graphs}.
|
DirectedWeightedGraphBuilderBase<V,E,G extends DirectedGraph<V,E> & WeightedGraph<V,E>,B extends DirectedWeightedGraphBuilderBase<V,E,G,B>> |
|
DirectedWeightedMultigraph<V,E> |
A directed weighted multigraph.
|
DirectedWeightedPseudograph<V,E> |
A directed weighted pseudograph.
|
DirectedWeightedSubgraph<V,E> |
A directed weighted graph that is a subgraph of another graph.
|
EdgeBasedTwoApproxVCImpl<V,E> |
Finds a 2-approximation for a minimum vertex cover A vertex cover is a set of vertices that
touches all the edges in the graph.
|
EdgeFactory<V,E> |
An edge factory used by graphs for creating new edges.
|
EdgeReversedGraph<V,E> |
Provides an edge-reversed view g' of a directed graph g.
|
EdgeSetFactory<V,E> |
A factory for edge sets.
|
EdgeTraversalEvent<E> |
A traversal event for a graph edge.
|
EdmondsBlossomShrinking<V,E> |
Deprecated.
|
EdmondsBlossomShrinking<V,E> |
An implementation of Edmonds Blossom Shrinking algorithm for constructing maximum matchings on
graphs.
|
EdmondsKarpMFImpl<V,E> |
A flow network is a directed graph
where each edge has a capacity and each edge receives a flow.
|
EmptyGraphGenerator<V,E> |
|
EulerianCircuit |
Deprecated.
|
EulerianCycleAlgorithm<V,E> |
Computes an Eulerian cycle of an Eulerian graph.
|
ExactAlgorithm<ResultType,V> |
An interface for an exact algorithm.
|
Extension |
Class which represents an abstract extension/encapsulation object.
|
ExtensionFactory<B extends Extension> |
Factory class which creates extension/encapsulation objects
|
ExtensionManager<T,B extends Extension> |
Convenience class to manage extensions/encapsulations.
|
FastLookupDirectedSpecifics<V,E> |
Fast implementation of DirectedSpecifics.
|
FastLookupUndirectedSpecifics<V,E> |
Fast implementation of UndirectedSpecifics.
|
FibonacciHeap<T> |
This class implements a Fibonacci heap data structure.
|
FibonacciHeapNode<T> |
Implements a node of the Fibonacci heap.
|
FloydWarshallShortestPaths<V,E> |
Deprecated.
|
FloydWarshallShortestPaths<V,E> |
The Floyd-Warshall algorithm.
|
GabowStrongConnectivityInspector<V,E> |
Allows obtaining the strongly connected components of a directed graph.
|
GabowStrongConnectivityInspector.VertexNumber<V> |
|
GnmRandomBipartiteGraphGenerator<V,E> |
Create a random bipartite graph based on the G(n, M) Erdős–Rényi model.
|
GnmRandomGraphGenerator<V,E> |
Create a random graph based on the G(n, M) Erdős–Rényi model.
|
GnpRandomBipartiteGraphGenerator<V,E> |
Create a random bipartite graph based on the G(n, p) Erdős–Rényi model.
|
GnpRandomGraphGenerator<V,E> |
Create a random graph based on the G(n, p) Erdős–Rényi model.
|
Graph<V,E> |
The root interface in the graph hierarchy.
|
GraphChangeEvent |
An event which indicates that a graph has changed.
|
GraphDelegator<V,E> |
A graph backed by the the graph specified at the constructor, which delegates all its methods to
the backing graph.
|
GraphEdgeChangeEvent<V,E> |
An event which indicates that a graph edge has changed, or is about to change.
|
GraphGenerator<V,E,T> |
An interface for generating new graph structures.
|
GraphIterator<V,E> |
A graph iterator.
|
GraphListener<V,E> |
A listener that is notified when the graph changes.
|
GraphMapping<V,E> |
GraphMapping represents a bidirectional mapping between two graphs (called graph1 and graph2),
which allows the caller to obtain the matching vertex or edge in either direction, from graph1 to
graph2, or from graph2 to graph1.
|
GraphOrdering<V,E> |
This class represents the order on the graph vertices.
|
GraphOrdering.GeneralVertexDegreeComparator<V2> |
|
GraphPath<V,E> |
|
Graphs |
A collection of utilities to assist with graph manipulation.
|
GraphSquare<V,E> |
A unmodifiable graph which is the squared graph of another.
|
GraphTests |
A collection of utilities to test for various graph properties.
|
GraphUnion<V,E,G extends Graph<V,E>> |
Read-only union of two graphs: G1 and G2.
|
GraphVertexChangeEvent<V> |
An event which indicates that a graph vertex has changed, or is about to change.
|
GraphWalk<V,E> |
A walk in a graph is an alternating sequence of vertices and edges, starting and ending at a
vertex, in which each edge is adjacent in the sequence to its two endpoints.
|
GreedyColoring<V,E> |
Compute greedy graph colorings.
|
GreedyMultiplicativeSpanner<V,E> |
Deprecated.
|
GreedyMultiplicativeSpanner<V,E> |
Greedy algorithm for (2k-1)-multiplicative spanner construction (for any integer
k >= 1).
|
GreedyVCImpl<V,E> |
Greedy algorithm to find a vertex cover for a graph.
|
GreedyWeightedMatching<V,E> |
The greedy algorithm for computing a maximum weight matching in an arbitrary graph.
|
GridGraphGenerator<V,E> |
|
GusfieldEquivalentFlowTree<V,E> |
This class computes an Equivalent Flow Tree (EFT) using the algorithm proposed by Dan Gusfield.
|
GusfieldGomoryHuCutTree<V,E> |
This class computes a Gomory-Hu tree (GHT) using the algorithm proposed by Dan Gusfield.
|
HamiltonianCycle |
This class will deal with finding the optimal or approximately optimal minimum tour (hamiltonian
cycle) or commonly known as the
Traveling Salesman
Problem.
|
HawickJamesSimpleCycles<V,E> |
Find all simple cycles of a directed graph using the algorithm described by Hawick and James.
|
HawickJamesSimpleCycles.Operation |
|
HierholzerEulerianCycle<V,E> |
An implementation of Hierholzer's algorithm for finding an Eulerian cycle in Eulerian graphs.
|
HopcroftKarpBipartiteMatching<V,E> |
Deprecated.
|
HopcroftKarpBipartiteMatching<V,E> |
This class is an implementation of the Hopcroft-Karp algorithm which finds a maximum matching in
an undirected simple bipartite graph.
|
HyperCubeGraphGenerator<V,E> |
|
IntArrayGraphAlgorithm<V,E> |
|
IntrusiveEdge |
IntrusiveEdge encapsulates the internals for the default edge implementation.
|
IsomorphicGraphMapping<V,E> |
This class represents a GraphMapping between two (subgraph)isomorphic graphs.
|
IsomorphismInspector<V,E> |
General interface for graph and subgraph isomorphism.
|
JohnsonSimpleCycles<V,E> |
Find all simple cycles of a directed graph using the Johnson's algorithm.
|
KosarajuStrongConnectivityInspector<V,E> |
Complements the ConnectivityInspector class with the capability to
compute the strongly connected components of a directed graph.
|
KosarajuStrongConnectivityInspector.VertexData<V> |
|
KosarajuStrongConnectivityInspector.VertexData1<V> |
|
KosarajuStrongConnectivityInspector.VertexData2<V> |
|
KruskalMinimumSpanningTree<V,E> |
Deprecated.
|
KruskalMinimumSpanningTree<V,E> |
|
KShortestPathAlgorithm<V,E> |
An algorithm which computes k-shortest paths between vertices.
|
KShortestPaths<V,E> |
Deprecated.
|
KShortestPaths<V,E> |
The algorithm determines the k shortest simple paths in increasing order of weight.
|
KShortestPathsIterator<V,E> |
Deprecated.
|
KShortestPathsIterator<V,E> |
|
KuhnMunkresMinimalWeightBipartitePerfectMatching<V,E> |
Deprecated.
|
KuhnMunkresMinimalWeightBipartitePerfectMatching<V,E> |
Kuhn-Munkres algorithm (named in honor of Harold Kuhn and James Munkres) solving assignment
problem also known as hungarian
algorithm (in the honor of hungarian mathematicians Dénes K?nig and Jen? Egerváry).
|
KuhnMunkresMinimalWeightBipartitePerfectMatching.KuhnMunkresMatrixImplementation<V,E> |
The actual implementation.
|
KuhnMunkresMinimalWeightBipartitePerfectMatching.KuhnMunkresMatrixImplementation<V,E> |
The actual implementation.
|
LinearGraphGenerator<V,E> |
Generates a linear graph of any size.
|
ListenableDirectedGraph<V,E> |
|
ListenableDirectedWeightedGraph<V,E> |
|
ListenableGraph<V,E> |
A graph that supports listeners on structural change events.
|
ListenableUndirectedGraph<V,E> |
|
ListenableUndirectedWeightedGraph<V,E> |
|
ListSingleSourcePathsImpl<V,E> |
|
MaskEdgeSet<V,E> |
|
MaskFunctor<V,E> |
Deprecated.
|
MaskSubgraph<V,E> |
An unmodifiable subgraph induced by a vertex/edge masking function.
|
MaskVertexSet<V> |
|
MatchingAlgorithm<V,E> |
Allows to derive a matching of
a given graph.
|
MatchingAlgorithm.Matching<E> |
A graph matching.
|
MatchingAlgorithm.MatchingImpl<E> |
A default implementation of the matching interface.
|
MathUtil |
Math Utilities.
|
MaximumFlowAlgorithm<V,E> |
|
MaximumFlowAlgorithm.MaximumFlow<E> |
A maximum flow
|
MaximumFlowAlgorithm.MaximumFlowImpl<E> |
Default implementation of the maximum flow
|
MaximumFlowAlgorithmBase<V,E> |
|
MaximumWeightBipartiteMatching<V,E> |
This class finds a maximum weight matching of a simple undirected weighted bipartite graph.
|
MaximumWeightBipartiteMatching<V,E> |
Deprecated.
|
MinimumSpanningTree<V,E> |
Deprecated.
|
MinimumSTCutAlgorithm<V,E> |
Given a weighted graph G(V,E) (directed or undirected).
|
MinimumVertexCoverAlgorithm<V,E> |
Computes a vertex cover in an undirected graph.
|
MinimumVertexCoverAlgorithm.VertexCover<V> |
A vertex cover
|
MinimumVertexCoverAlgorithm.VertexCoverImpl<V> |
Default implementation of a vertex cover
|
MinimumWeightedVertexCoverAlgorithm<V,E> |
Computes a weighted vertex cover in an undirected graph.
|
MixedGraphUnion<V,E> |
Read-only union of an undirected and a directed graph.
|
ModifiableInteger |
The ModifiableInteger class wraps a value of the primitive type int in
an object, similarly to Integer .
|
Multigraph<V,E> |
A multigraph.
|
NaiveLcaFinder<V,E> |
Find the Lowest Common Ancestor of a directed graph.
|
NeighborIndex<V,E> |
Maintains a cache of each vertex's neighbors.
|
NeighborIndex.Neighbors<V> |
Stores cached neighbors for a single vertex.
|
PadbergRaoOddMinimumCutset<V,E> |
Implementation of the algorithm by Padberg and Rao to compute Odd Minimum Cut-Sets.
|
PageRank<V,E> |
PageRank implementation.
|
Pair<A,B> |
Generic pair.
|
ParanoidGraph<V,E> |
ParanoidGraph provides a way to verify that objects added to a graph obey the standard
equals/hashCode contract.
|
PathGrowingWeightedMatching<V,E> |
A linear time 1/2-approximation algorithm for finding a maximum weight matching in an arbitrary
graph.
|
PathValidator<V,E> |
Deprecated.
|
PathValidator<V,E> |
May be used to provide external path validations in addition to the basic validations done by
KShortestPaths - that the path is from source to target and that it does not contain
loops.
|
PatonCycleBase<V,E> |
Find a cycle base of an undirected graph using the Paton's algorithm.
|
PrefetchIterator<E> |
Utility class to help implement an iterator/enumerator in which the hasNext() method needs to
calculate the next elements ahead of time.
|
PrefetchIterator.NextElementFunctor<EE> |
A functor for the calculation of the next element.
|
PrimMinimumSpanningTree<V,E> |
Deprecated.
|
PrimMinimumSpanningTree<V,E> |
An implementation of Prim's
algorithm that finds a minimum spanning tree/forest subject to connectivity of the supplied
weighted undirected graph.
|
Pseudograph<V,E> |
A pseudograph.
|
PushRelabelMFImpl<V,E> |
|
RandomWalkIterator<V,E> |
A random-walk
iterator for a directed and an undirected graph.
|
RankingPathElement<V,E> |
Deprecated.
|
RankingPathElement<V,E> |
|
RankingPathElementList<V,E> |
Deprecated.
|
RankingPathElementList<V,E> |
List of simple paths in increasing order of weight.
|
RankingPathElementList.PathMask<V,E> |
|
RankingPathElementList.PathMask<V,E> |
|
RatioVertex<V> |
Helper class for vertex covers.
|
RecursiveExactVCImpl<V,E> |
Finds a minimum vertex cover in a undirected graph.
|
RingGraphGenerator<V,E> |
Generates a ring graph of any size.
|
ScaleFreeGraphGenerator<V,E> |
|
ShortestPathAlgorithm<V,E> |
An algorithm which computes shortest paths between vertices.
|
ShortestPathAlgorithm.SingleSourcePaths<V,E> |
A set of paths starting from a single source vertex.
|
SimpleDirectedGraph<V,E> |
A simple directed graph.
|
SimpleDirectedWeightedGraph<V,E> |
A simple directed weighted graph.
|
SimpleGraph<V,E> |
A simple graph.
|
SimpleWeightedBipartiteGraphMatrixGenerator<V,E> |
A simple weighted bipartite graph matrix generator.
|
SimpleWeightedGraph<V,E> |
A simple weighted graph.
|
SimpleWeightedGraphMatrixGenerator<V,E> |
A simple weighted graph matrix generator.
|
SpannerAlgorithm<E> |
|
SpannerAlgorithm.Spanner<E> |
A graph spanner.
|
SpannerAlgorithm.SpannerImpl<E> |
Default implementation of the spanner interface.
|
SpanningTreeAlgorithm<E> |
An algorithm which computes a spanning
tree of a given connected graph.
|
SpanningTreeAlgorithm.SpanningTree<E> |
A spanning tree.
|
SpanningTreeAlgorithm.SpanningTreeImpl<E> |
Default implementation of the spanning tree interface.
|
Specifics<V,E> |
An interface encapsulating the basic graph operations.
|
StarGraphGenerator<V,E> |
|
StoerWagnerMinimumCut<V,E> |
|
StrongConnectivityAlgorithm<V,E> |
An interface to the StrongConnectivityInspector algorithm classes.
|
Subgraph<V,E,G extends Graph<V,E>> |
A subgraph is a graph that has a subset of vertices and a subset of edges with respect to some
base graph.
|
SzwarcfiterLauerSimpleCycles<V,E> |
Find all simple cycles of a directed graph using the Schwarcfiter and Lauer's algorithm.
|
TarjanLowestCommonAncestor<V,E> |
Used to calculate Tarjan's Lowest Common Ancestors Algorithm
|
TarjanLowestCommonAncestor.LcaRequestResponse<V> |
Data transfer object for LCA request and response.
|
TarjanLowestCommonAncestor.MultiMap<V> |
|
TarjanSimpleCycles<V,E> |
Find all simple cycles of a directed graph using the Tarjan's algorithm.
|
TiernanSimpleCycles<V,E> |
Find all simple cycles of a directed graph using the Tiernan's algorithm.
|
ToleranceDoubleComparator |
A double comparator with adjustable tolerance.
|
TopologicalOrderIterator<V,E> |
Implements topological order traversal for a directed acyclic graph.
|
TopologicalOrderIterator.LinkedListQueue<T> |
|
TransitiveClosure |
Constructs the transitive closure of the input graph.
|
TransitiveReduction |
|
TraversalListener<V,E> |
A listener on graph iterator or on a graph traverser.
|
TraversalListenerAdapter<V,E> |
An empty do-nothing implementation of the TraversalListener interface used for
subclasses.
|
TreeSingleSourcePathsImpl<V,E> |
|
TypeUtil<T> |
TypeUtil isolates type-unsafety so that code which uses it for legitimate reasons can stay
warning-free.
|
UndirectedCycleBase<V,E> |
A common interface for classes implementing algorithms for finding a cycle base of an undirected
graph.
|
UndirectedEdgeContainer<V,E> |
A container for vertex edges.
|
UndirectedGraph<V,E> |
A graph whose all edges are undirected.
|
UndirectedGraphBuilder<V,E,G extends UndirectedGraph<V,E>> |
A builder class for Graph .
|
UndirectedGraphBuilderBase<V,E,G extends UndirectedGraph<V,E>,B extends UndirectedGraphBuilderBase<V,E,G,B>> |
|
UndirectedGraphUnion<V,E> |
An undirected version of the read-only union of two graphs.
|
UndirectedMaskSubgraph<V,E> |
An undirected graph that is a MaskSubgraph of another graph.
|
UndirectedSpecifics<V,E> |
Plain implementation of UndirectedSpecifics.
|
UndirectedSubgraph<V,E> |
An undirected graph that is a subgraph of another graph.
|
UndirectedWeightedGraphBuilder<V,E,G extends UndirectedGraph<V,E> & WeightedGraph<V,E>> |
A builder class for undirected weighted graphs.
|
UndirectedWeightedGraphBuilderBase<V,E,G extends UndirectedGraph<V,E> & WeightedGraph<V,E>,B extends UndirectedWeightedGraphBuilderBase<V,E,G,B>> |
|
UndirectedWeightedSubgraph<V,E> |
An undirected weighted graph that is a subgraph on other graph.
|
UnionFind<T> |
|
UnmodifiableDirectedGraph<V,E> |
A directed graph that cannot be modified.
|
UnmodifiableGraph<V,E> |
An unmodifiable view of the backing graph specified in the constructor.
|
UnmodifiableUndirectedGraph<V,E> |
An undirected graph that cannot be modified.
|
UnorderedPair<A,B> |
Generic unordered pair.
|
UnorderedVertexPair<V> |
Deprecated.
|
VertexDegreeComparator<V,E> |
Compares two vertices based on their degree.
|
VertexDegreeComparator.Order |
Order in which we sort the vertices: ascending vertex degree or descending vertex degree
|
VertexFactory<V> |
A vertex factory used by graph algorithms for creating new vertices.
|
VertexPair<V> |
Deprecated.
|
VertexScoringAlgorithm<V,D> |
An interface for all algorithms which assign scores to vertices of a graph.
|
VertexSetListener<V> |
A listener that is notified when the graph's vertex set changes.
|
VertexTraversalEvent<V> |
A traversal event for a graph vertex.
|
VF2AbstractIsomorphismInspector<V,E> |
|
VF2GraphIsomorphismInspector<V,E> |
|
VF2GraphIsomorphismState<V,E> |
|
VF2GraphMappingIterator<V,E> |
This class is used to iterate over all existing (isomorphic) mappings between two graphs.
|
VF2MappingIterator<V,E> |
|
VF2State<V,E> |
controls the matching between two graphs according to the VF2 algorithm.
|
VF2SubgraphIsomorphismInspector<V,E> |
|
VF2SubgraphIsomorphismState<V,E> |
|
VF2SubgraphMappingIterator<V,E> |
This class is used to iterate over all existing (subgraph isomorphic) mappings between two
graphs.
|
WeightCombiner |
Binary operator for edge weights.
|
WeightedGraph<V,E> |
An interface for a graph whose edges have non-uniform weights.
|
WeightedGraphGenerator<V,E> |
A base implementation of a weighted graph generator.
|
WeightedGraphGeneratorAdapter<V,E,T> |
An interface for generating graph structures having edges weighted with real values.
|
WeightedMatchingAlgorithm<V,E> |
Deprecated.
|
WeightedMultigraph<V,E> |
A weighted multigraph.
|
WeightedPseudograph<V,E> |
A weighted pseudograph.
|
WheelGraphGenerator<V,E> |
|