Classes | Macros | Typedefs | Variables
global.h File Reference
#include <string>
#include <string.h>
#include "../include/se2/se2.h"
#include <CGAL/Exact_predicates_inexact_constructions_kernel.h>
#include <CGAL/Triangulation_vertex_base_with_info_2.h>
#include <CGAL/Polygon_2.h>
#include <CGAL/Polygon_with_holes_2.h>
#include <CGAL/Boolean_set_operations_2.h>
#include <CGAL/Constrained_Delaunay_triangulation_2.h>
#include <CGAL/Triangulation_face_base_with_info_2.h>
#include <CGAL/intersections.h>
#include <opencv2/opencv.hpp>
#include <opencv2/core/core.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <opencv2/imgproc/imgproc.hpp>
Include dependency graph for global.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  FaceInfo2
 

Macros

#define PI   3.1415926
 

Typedefs

typedef CGAL::Constrained_Delaunay_triangulation_2< K, TDS, ItagCDT
 
typedef CGAL::Constrained_triangulation_face_base_2< K, FbbFb
 
typedef CGAL::Triangulation_face_base_with_info_2< FaceInfo2, KFbb
 
typedef CGAL::Exact_predicates_tag Itag
 
typedef CGAL::Exact_predicates_inexact_constructions_kernel K
 
typedef K::Point_2 Point_2
 
typedef CGAL::Polygon_2< KPolygon_2
 
typedef CGAL::Polygon_with_holes_2< KPolygon_with_holes_2
 
typedef std::list< Polygon_with_holes_2Pwh_list_2
 
typedef CGAL::Triangulation_data_structure_2< Vb, FbTDS
 
typedef CGAL::Triangulation_vertex_base_2< KVb
 

Variables

const std::string cdt_obj_path = "cdt.obj"
 
const std::string cdt_off_path = "cdt.off"
 
const std::string communicateFile = "communication"
 
double compactParam
 
const std::string domainFilePath = "domain"
 
double g_angleDifference
 
float g_camera_height
 
std::vector< std::vector< iro::SE2 > > g_camTrajectories
 
double g_distance_step
 
bool g_fpInterpolation
 
int g_plan_iteration
 
std::vector< std::vector< Point_2 > > g_rbtTrajectories
 
std::vector< cv::Point > g_scene_boundary
 
const std::string holeFilePath = "hole"
 
const std::string poly_diff = "devel_isolated/co_scan/lib/co_scan/poly_diff"
 
const std::string resultFilePath = "diff_result"
 

Macro Definition Documentation

◆ PI

#define PI   3.1415926

Definition at line 13 of file global.h.

Typedef Documentation

◆ CDT

typedef CGAL::Constrained_Delaunay_triangulation_2<K, TDS, Itag> CDT

Definition at line 48 of file global.h.

◆ Fb

typedef CGAL::Constrained_triangulation_face_base_2<K, Fbb> Fb

Definition at line 45 of file global.h.

◆ Fbb

typedef CGAL::Triangulation_face_base_with_info_2<FaceInfo2, K> Fbb

Definition at line 44 of file global.h.

◆ Itag

typedef CGAL::Exact_predicates_tag Itag

Definition at line 47 of file global.h.

◆ K

typedef CGAL::Exact_predicates_inexact_constructions_kernel K

Definition at line 31 of file global.h.

◆ Point_2

typedef K::Point_2 Point_2

Definition at line 32 of file global.h.

◆ Polygon_2

typedef CGAL::Polygon_2<K> Polygon_2

Definition at line 33 of file global.h.

◆ Polygon_with_holes_2

typedef CGAL::Polygon_with_holes_2<K> Polygon_with_holes_2

Definition at line 49 of file global.h.

◆ Pwh_list_2

typedef std::list<Polygon_with_holes_2> Pwh_list_2

Definition at line 50 of file global.h.

◆ TDS

typedef CGAL::Triangulation_data_structure_2<Vb, Fb> TDS

Definition at line 46 of file global.h.

◆ Vb

typedef CGAL::Triangulation_vertex_base_2<K> Vb

Definition at line 43 of file global.h.

Variable Documentation

◆ cdt_obj_path

const std::string cdt_obj_path = "cdt.obj"

Definition at line 10 of file global.h.

◆ cdt_off_path

const std::string cdt_off_path = "cdt.off"

Definition at line 11 of file global.h.

◆ communicateFile

const std::string communicateFile = "communication"

Definition at line 8 of file global.h.

◆ compactParam

double compactParam

Definition at line 5 of file global.cpp.

◆ domainFilePath

const std::string domainFilePath = "domain"

Definition at line 5 of file global.h.

◆ g_angleDifference

double g_angleDifference

Definition at line 8 of file global.cpp.

◆ g_camera_height

float g_camera_height

Definition at line 15 of file global.cpp.

◆ g_camTrajectories

std::vector<std::vector<iro::SE2> > g_camTrajectories

Definition at line 14 of file global.cpp.

◆ g_distance_step

double g_distance_step

Definition at line 6 of file global.cpp.

◆ g_fpInterpolation

bool g_fpInterpolation

Definition at line 10 of file global.cpp.

◆ g_plan_iteration

int g_plan_iteration

Definition at line 17 of file global.cpp.

◆ g_rbtTrajectories

std::vector<std::vector<Point_2> > g_rbtTrajectories

Definition at line 13 of file global.cpp.

◆ g_scene_boundary

std::vector<cv::Point> g_scene_boundary

Definition at line 19 of file global.cpp.

◆ holeFilePath

const std::string holeFilePath = "hole"

Definition at line 6 of file global.h.

◆ poly_diff

const std::string poly_diff = "devel_isolated/co_scan/lib/co_scan/poly_diff"

Definition at line 9 of file global.h.

◆ resultFilePath

const std::string resultFilePath = "diff_result"

Definition at line 7 of file global.h.



co_scan
Author(s):
autogenerated on Mon Feb 28 2022 23:00:57