#include <boost/assign/std/list.hpp>#include <boost/assign/std/set.hpp>#include <boost/assign/std/vector.hpp>#include <boost/make_shared.hpp>#include <CppUnitLite/TestHarness.h>#include "SubmapPlanarSLAM.h"#include "SubmapVisualSLAM.h"#include "SubmapExamples.h"#include "SubmapExamples3D.h"#include "GenericGraph.h"#include "NonlinearTSAM.h"#include "partition/NestedDissection-inl.h"
Go to the source code of this file.
| Functions | |
| int | main () | 
| TEST (NestedDissection, oneIsland) | |
| TEST (NestedDissection, TwoIslands) | |
| TEST (NestedDissection, FourIslands) | |
| TEST (NestedDissection, weekLinks) | |
| TEST (NestedDissection, manual_cuts) | |
| TEST (NestedDissection, Graph3D) | |
| int main | ( | void | ) | 
Definition at line 337 of file testNestedDissection.cpp.
| TEST | ( | NestedDissection | , | 
| oneIsland | |||
| ) | 
Definition at line 32 of file testNestedDissection.cpp.
| TEST | ( | NestedDissection | , | 
| TwoIslands | |||
| ) | 
Definition at line 56 of file testNestedDissection.cpp.
| TEST | ( | NestedDissection | , | 
| FourIslands | |||
| ) | 
Definition at line 93 of file testNestedDissection.cpp.
| TEST | ( | NestedDissection | , | 
| weekLinks | |||
| ) | 
Definition at line 137 of file testNestedDissection.cpp.
| TEST | ( | NestedDissection | , | 
| manual_cuts | |||
| ) | 
l1 l2 l3 | X | X | x0 - x1 - x2 | X | X | l4 l5 l6
Definition at line 184 of file testNestedDissection.cpp.
| TEST | ( | NestedDissection | , | 
| Graph3D | |||
| ) | 
Definition at line 273 of file testNestedDissection.cpp.