#include <string>#include <strings.h>#include <eigen_conversions/eigen_msg.h>#include <ram_msgs/AdditiveManufacturingTrajectory.h>#include <ram_path_planning/contours.hpp>#include <ram_path_planning/donghong_ding.hpp>#include <ram_path_planning/mesh_slicer.hpp>#include <ram_path_planning/vtkRenderUpdaterTimer.hpp>#include <ros/ros.h>#include <visualization_msgs/Marker.h>#include <actionlib/server/action_server.h>#include <ram_path_planning/follow_poses.hpp>#include <ram_path_planning/ContoursAction.h>#include <ram_path_planning/DonghongDingAction.h>#include <ram_path_planning/FollowPosesAction.h>#include <unique_id/unique_id.h>
Go to the source code of this file.
Typedefs | |
| typedef std::vector< PolygonVector > | Layer |
| typedef vtkSmartPointer< vtkPolyData > | Polygon |
| typedef std::vector< Polygon > | PolygonVector |
Functions | |
| void | contoursAlgorithmCancelCb (actionlib::ServerGoalHandle< ram_path_planning::ContoursAction > gh) |
| void | contoursAlgorithmGoalCb (actionlib::ServerGoalHandle< ram_path_planning::ContoursAction > gh) |
| void | donghongDingAlgorithmCancelCb (actionlib::ServerGoalHandle< ram_path_planning::DonghongDingAction > gh) |
| void | donghongDingAlgorithmGoalCb (actionlib::ServerGoalHandle< ram_path_planning::DonghongDingAction > gh) |
| std::string | fileExtension (const std::string full_path) |
| void | FollowPosesAlgorithmCancelCb (actionlib::ServerGoalHandle< ram_path_planning::FollowPosesAction > gh) |
| void | FollowPosesAlgorithmGoalCb (actionlib::ServerGoalHandle< ram_path_planning::FollowPosesAction > gh) |
| int | main (int argc, char **argv) |
Variables | |
| vtkSmartPointer< vtkRendererUpdaterTimer > | cb = vtkSmartPointer<vtkRendererUpdaterTimer>::New() |
| ram_path_planning::Contours< ram_path_planning::ContoursAction > | contour_generator |
| ram_path_planning::DonghongDing< ram_path_planning::DonghongDingAction > | donghongding_generator |
| ram_path_planning::FollowPoses< ram_path_planning::FollowPosesAction > | follow_poses_generator |
| std::unique_ptr< ros::Publisher > | traj_pub |
| bool | use_gui |
| typedef std::vector<PolygonVector> Layer |
Definition at line 23 of file path_planning.cpp.
| typedef vtkSmartPointer<vtkPolyData> Polygon |
Definition at line 21 of file path_planning.cpp.
| typedef std::vector<Polygon> PolygonVector |
Definition at line 22 of file path_planning.cpp.
| void contoursAlgorithmCancelCb | ( | actionlib::ServerGoalHandle< ram_path_planning::ContoursAction > | gh | ) |
Definition at line 556 of file path_planning.cpp.
| void contoursAlgorithmGoalCb | ( | actionlib::ServerGoalHandle< ram_path_planning::ContoursAction > | gh | ) |
Definition at line 321 of file path_planning.cpp.
| void donghongDingAlgorithmCancelCb | ( | actionlib::ServerGoalHandle< ram_path_planning::DonghongDingAction > | gh | ) |
Definition at line 313 of file path_planning.cpp.
| void donghongDingAlgorithmGoalCb | ( | actionlib::ServerGoalHandle< ram_path_planning::DonghongDingAction > | gh | ) |
Definition at line 52 of file path_planning.cpp.
| std::string fileExtension | ( | const std::string | full_path | ) |
Definition at line 36 of file path_planning.cpp.
| void FollowPosesAlgorithmCancelCb | ( | actionlib::ServerGoalHandle< ram_path_planning::FollowPosesAction > | gh | ) |
Definition at line 707 of file path_planning.cpp.
| void FollowPosesAlgorithmGoalCb | ( | actionlib::ServerGoalHandle< ram_path_planning::FollowPosesAction > | gh | ) |
Definition at line 564 of file path_planning.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 714 of file path_planning.cpp.
| vtkSmartPointer<vtkRendererUpdaterTimer> cb = vtkSmartPointer<vtkRendererUpdaterTimer>::New() |
Definition at line 34 of file path_planning.cpp.
| ram_path_planning::Contours<ram_path_planning::ContoursAction> contour_generator |
Definition at line 30 of file path_planning.cpp.
| ram_path_planning::DonghongDing<ram_path_planning::DonghongDingAction> donghongding_generator |
Definition at line 29 of file path_planning.cpp.
| ram_path_planning::FollowPoses<ram_path_planning::FollowPosesAction> follow_poses_generator |
Definition at line 31 of file path_planning.cpp.
| std::unique_ptr<ros::Publisher> traj_pub |
Definition at line 27 of file path_planning.cpp.
| bool use_gui |
Definition at line 25 of file path_planning.cpp.