Skip to content

Commit

Permalink
Fix merge conflict
Browse files Browse the repository at this point in the history
  • Loading branch information
christophfroehlich committed Sep 14, 2023
1 parent 31afb42 commit 16a8828
Showing 1 changed file with 0 additions and 5 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -265,11 +265,6 @@ controller_interface::return_type JointTrajectoryController::update(
if (active_tol->goal_time_tolerance != 0.0)
{
// if we exceed goal_time_tolerance set it to aborted
const rclcpp::Time traj_start = traj_external_point_ptr_->get_trajectory_start_time();
const rclcpp::Time traj_end = traj_start + start_segment_itr->time_from_start;

time_difference = time.seconds() - traj_end.seconds();

if (time_difference > active_tol->goal_time_tolerance)
{
within_goal_time = false;
Expand Down

0 comments on commit 16a8828

Please sign in to comment.