34 std::vector<double> linear_path, angular_path, path;
35 std::vector<double> path_matrix[2];
36 geometry_msgs::Pose
pose;
53 linear_path = path_matrix[0];
54 angular_path = path_matrix[1];
56 if (fabs(linear_path.back()) > fabs(angular_path.back()))
64 norm_factor = 1/path.back();
67 for (
unsigned int i = 0; i < linear_path.size(); i++)
69 if (linear_path.back() == 0)
83 pose_array.poses.push_back(
pose);
97 std::vector<double> path_array;
98 std::vector<double> path_matrix[2];
100 geometry_msgs::Pose
pose;
123 path_array = path_matrix[0];
130 for (
unsigned int i = 0; i < path_array.size(); i++)
138 q.
setRPY(0, -path_array.at(i), 0);
143 q.
setRPY(0, path_array.at(i), 0);
154 pose_array.poses.push_back(
pose);