mesh_slicer.hpp
Go to the documentation of this file.
1 #ifndef RAM_PATH_PLANNING_MESH_SLICER_HPP
2 #define RAM_PATH_PLANNING_MESH_SLICER_HPP
3 
4 #include <ros/ros.h>
7 
8 #include <vtkActor.h>
9 #include <vtkCutter.h>
10 #include <vtkInteractorStyleTrackballCamera.h>
11 #include <vtkOBJReader.h>
12 #include <vtkPLYReader.h>
13 #include <vtkPlane.h>
14 #include <vtkPolyDataMapper.h>
15 #include <vtkProperty.h>
16 #include <vtkRenderWindow.h>
17 #include <vtkRenderWindowInteractor.h>
18 #include <vtkRenderer.h>
19 #include <vtkSTLReader.h>
20 #include <vtkStripper.h>
21 #include <vtkTriangleFilter.h>
22 
23 namespace ram_path_planning
24 {
25 typedef vtkSmartPointer<vtkPolyData> Polygon;
26 typedef std::vector<Polygon> PolygonVector;
27 typedef std::vector<PolygonVector> Layer;
28 
29 bool readPolygonFile(const std::string file_name,
30  const vtkSmartPointer<vtkPolyData> poly_data);
31 
32 unsigned sliceMesh(std::vector<Layer> &trajectory,
33  const std::string file_name,
34  const vtkSmartPointer<vtkPolyData> poly_data,
35  vtkSmartPointer<vtkStripper> &stripper,
36  const double height_between_layers,
37  const std::array<double, 3> slicing_direction,
38  const bool use_gui = false);
39 }
40 
41 #endif
bool readPolygonFile(const std::string file_name, const vtkSmartPointer< vtkPolyData > poly_data)
Definition: mesh_slicer.cpp:20
unsigned sliceMesh(std::vector< Layer > &trajectory, const std::string file_name, const vtkSmartPointer< vtkPolyData > poly_data, vtkSmartPointer< vtkStripper > &stripper, const double height_between_layers, const std::array< double, 3 > slicing_direction, const bool use_gui=false)
Definition: mesh_slicer.cpp:66
std::vector< PolygonVector > Layer
Definition: mesh_slicer.hpp:27
vtkSmartPointer< vtkPolyData > Polygon
Definition: mesh_slicer.hpp:25
std::vector< Polygon > PolygonVector
Definition: mesh_slicer.hpp:26
bool use_gui


ram_path_planning
Author(s): Andres Campos - Institut Maupertuis
autogenerated on Mon Jun 10 2019 14:50:03