Skip to content

Commit

Permalink
hack, please investigate
Browse files Browse the repository at this point in the history
  • Loading branch information
LeroyR committed Jul 9, 2024
1 parent abbe0b7 commit 1b3081f
Showing 1 changed file with 8 additions and 0 deletions.
8 changes: 8 additions & 0 deletions capabilities/src/execute_task_solution_capability.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -166,6 +166,14 @@ bool ExecuteTaskSolutionCapability::constructMotionPlan(const moveit_task_constr
exec_traj.trajectory_->setRobotTrajectoryMsg(state, sub_traj.trajectory);
exec_traj.controller_names_ = sub_traj.execution_info.controller_names;

for (int i = 1; i < exec_traj.trajectory_->getWayPointCount(); i++) {
auto from_prev = exec_traj.trajectory_->getWayPointDurationFromPrevious(i);
if(from_prev < 0.0001) {
ROS_ERROR_NAMED("ExecuteTaskSolution", "Found broken waypoint? fixing...");
exec_traj.trajectory_->setWayPointDurationFromPrevious(i, 0.0001);
}
}

/* TODO add action feedback and markers */
exec_traj.effect_on_success_ = [this,
&scene_diff = const_cast<::moveit_msgs::PlanningScene&>(sub_traj.scene_diff),
Expand Down

0 comments on commit 1b3081f

Please sign in to comment.