This is the complete list of members for ram_path_planning::DonghongDing< ActionSpec >, including all inherited members.
angleBetweenVectors(const double v1[3], const double v2[3]) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
calculation_tol_ | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
closest_to_bisector_ | ram_path_planning::DonghongDing< ActionSpec > | private |
computeNormal(vtkPoints *p, double *n) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
connectLayersWithOnePolygon(actionlib::ServerGoalHandle< ActionSpec > &gh, const int current_progrress_value, const int next_progress_value, std::vector< Layer > &layers, ram_msgs::AdditiveManufacturingTrajectory &msg, const unsigned first_layer) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
connectMeshLayers(actionlib::ServerGoalHandle< ActionSpec > &gh, const int current_progrress_value, const int next_progress_value, std::vector< Layer > &layers, ram_msgs::AdditiveManufacturingTrajectory &msg) | ram_path_planning::DonghongDingBase< ActionSpec > | |
connectYamlLayers(actionlib::ServerGoalHandle< ActionSpec > &gh, const int current_progrress_value, const int next_progress_value, const Layer ¤t_layer, ram_msgs::AdditiveManufacturingTrajectory &msg, const double number_of_layers, const double height_between_layers, const std::array< double, 3 > offset_direction={0, 0, 1}) | ram_path_planning::DonghongDingBase< ActionSpec > | |
contours_filtering_tolerance_ | ram_path_planning::DonghongDing< ActionSpec > | private |
deposited_material_width_ | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
description_ | ram_path_planning::PathPlanningAlgorithm< ActionSpec > | |
divideInConvexPolygons(PolygonVector &polygon_source, const int polygon_position, const vtkSmartPointer< vtkPoints > split_points) | ram_path_planning::DonghongDing< ActionSpec > | private |
divideInLayersWithOnePolygon(std::vector< Layer > &layers, ram_msgs::AdditiveManufacturingTrajectory &msg, const unsigned first_layer) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
DonghongDing() | ram_path_planning::DonghongDing< ActionSpec > | |
DonghongDingBase(const std::string name, const std::string description, const std::string service_name) | ram_path_planning::DonghongDingBase< ActionSpec > | |
findIntersectWithBisector(const Polygon poly_data, const vtkIdType notch_cell_id, const vtkIdType notch_pos, vtkIdType &vertex_cell_id, vtkIdType &vertex_pos, double vertex[3]) | ram_path_planning::DonghongDing< ActionSpec > | private |
findNotch(const Polygon poly_data, vtkIdType &cell_id, vtkIdType &pos, double &angle) | ram_path_planning::DonghongDing< ActionSpec > | private |
findVertex(const Polygon poly_data, const vtkIdType notch_cell_id, const vtkIdType notch_pos, vtkIdType &vertex_cell_id, vtkIdType &vertex_pos, const double notch_angle) | ram_path_planning::DonghongDing< ActionSpec > | private |
generateOneLayerTrajectory(actionlib::ServerGoalHandle< ActionSpec > &gh, const int current_progrress_value, const int next_progress_value, const Polygon poly_data, Layer &layer, const double deposited_material_width, const double contours_filtering_tolerance, const std::array< double, 3 > normal_vector={0, 0, 1}, const double polygon_division_tolerance=M_PI/6, const bool closest_to_bisector=false, const bool use_gui=false) | ram_path_planning::DonghongDing< ActionSpec > | |
generateOneLayerTrajectory(actionlib::ServerGoalHandle< ActionSpec > &gh, const int current_progrress_value, const int next_progress_value, const std::string yaml_file, Layer &layer, const double deposited_material_width, const double contours_filtering_tolerance, const double polygon_division_tolerance=M_PI/6, const bool closest_to_bisector=false, const bool use_gui=false) | ram_path_planning::DonghongDing< ActionSpec > | |
generateTrajectoryInConvexPolygon(const Polygon poly_data) | ram_path_planning::DonghongDing< ActionSpec > | private |
identifyLeftChain(const Polygon poly_data, const vtkIdType edge_id, const vtkIdType opposite_point_id, const vtkSmartPointer< vtkPoints > left_chain, const vtkSmartPointer< vtkPoints > right_chain) | ram_path_planning::DonghongDing< ActionSpec > | private |
identifyRelationships(const Polygon poly_data, std::vector< int > &level, std::vector< int > &father) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
identifyZigzagDirection(const Polygon poly_data, vtkIdType &edge, vtkIdType &futhest_point) | ram_path_planning::DonghongDing< ActionSpec > | private |
intersectionBetweenContours(const Polygon poly_data) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
intersectLineWithContours(const Polygon poly_data, double point_1[3], double point_2[3]) | ram_path_planning::DonghongDing< ActionSpec > | private |
Layer typedef | ram_path_planning::DonghongDing< ActionSpec > | |
mergeColinearEdges(const Polygon poly_data, const double tolerance=1e-6) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
mergeConvexPolygons(PolygonVector &polygon_source, const vtkSmartPointer< vtkPoints > split_points, const vtkIdType split_line) | ram_path_planning::DonghongDing< ActionSpec > | private |
mergeListOfPoints(const Polygon poly_data, const vtkSmartPointer< vtkPoints > left_chain, const vtkSmartPointer< vtkPoints > right_chain, const vtkSmartPointer< vtkPoints > zigzag_points) | ram_path_planning::DonghongDing< ActionSpec > | private |
name_ | ram_path_planning::PathPlanningAlgorithm< ActionSpec > | |
normal_vector_ | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
offsetLeftChain(const Polygon poly_data, const vtkIdType edge_id, const vtkIdType opposite_point_id, const vtkSmartPointer< vtkPoints > left_chain, const vtkSmartPointer< vtkPoints > right_chain) | ram_path_planning::DonghongDing< ActionSpec > | private |
offsetPolygonContour(const Polygon poly_data, const double deposited_material_width) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
organizePolygonContoursInLayer(const Polygon poly_data, const std::vector< int > level, const std::vector< int > father, Layer &layer) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
PathPlanningAlgorithm(const std::string name, const std::string description, const std::string service_name) | ram_path_planning::PathPlanningAlgorithm< ActionSpec > | |
Polygon typedef | ram_path_planning::DonghongDing< ActionSpec > | |
polygon_division_tolerance_ | ram_path_planning::DonghongDing< ActionSpec > | private |
PolygonVector typedef | ram_path_planning::DonghongDing< ActionSpec > | |
publishPercentageDone(const unsigned percentage, actionlib::ServerGoalHandle< ActionSpec > &gh) | ram_path_planning::PathPlanningAlgorithm< ActionSpec > | |
publishStatusDone(const std::string progress_msg, actionlib::ServerGoalHandle< ActionSpec > &gh) | ram_path_planning::PathPlanningAlgorithm< ActionSpec > | |
publishStatusPercentageDone(const std::string progress_msg, const unsigned percentage, actionlib::ServerGoalHandle< ActionSpec > &gh) | ram_path_planning::PathPlanningAlgorithm< ActionSpec > | |
removeDuplicatePoints(const Polygon poly_data, const double tolerance=1e-6) | ram_path_planning::DonghongDingBase< ActionSpec > | protected |
semaphore_ | ram_path_planning::DonghongDing< ActionSpec > | private |
service_name_ | ram_path_planning::PathPlanningAlgorithm< ActionSpec > | |
verifyAngles(const Polygon poly_data, const vtkIdType notch_cell_id, const vtkIdType notch_pos, const vtkIdType vertex_cell_id, const vtkIdType vertex_pos) | ram_path_planning::DonghongDing< ActionSpec > | private |
zigzagGeneration(const Polygon poly_data, const vtkIdType edge_id, const vtkIdType opposite_point_id, const vtkSmartPointer< vtkPoints > zigzag_points, const double deposited_material_width) | ram_path_planning::DonghongDing< ActionSpec > | private |
~DonghongDingBase()=0 | ram_path_planning::DonghongDingBase< ActionSpec > | pure virtual |
~PathPlanningAlgorithm()=0 | ram_path_planning::PathPlanningAlgorithm< ActionSpec > | pure virtual |