Skip to content

Commit

Permalink
Fix deprecated
Browse files Browse the repository at this point in the history
Signed-off-by: Tyler Weaver <tylerjw@gmail.com>
  • Loading branch information
tylerjw committed May 10, 2022
1 parent 806cce4 commit 988dcaa
Showing 1 changed file with 2 additions and 2 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -107,8 +107,8 @@ class ConstrainedPlanningTestFixture : public ::testing::Test
move_group_->setPathConstraints(path_constraint);

moveit::planning_interface::MoveGroupInterface::Plan plan;
ASSERT_EQ(move_group_->plan(plan), moveit::planning_interface::MoveItErrorCode::SUCCESS);
ASSERT_EQ(move_group_->move(), moveit::planning_interface::MoveItErrorCode::SUCCESS);
ASSERT_EQ(move_group_->plan(plan), moveit::core::MoveItErrorCode::SUCCESS);
ASSERT_EQ(move_group_->move(), moveit::core::MoveItErrorCode::SUCCESS);
}

void testPose(const geometry_msgs::msg::PoseStamped& pose_goal_stamped)
Expand Down

0 comments on commit 988dcaa

Please sign in to comment.