Skip to content

Commit

Permalink
Updated test
Browse files Browse the repository at this point in the history
Signed-off-by: jakubach <[email protected]>
  • Loading branch information
Jakubach committed Nov 13, 2024
1 parent 46cddef commit 13bf10e
Showing 1 changed file with 1 addition and 2 deletions.
3 changes: 1 addition & 2 deletions nav2_docking/opennav_docking/test/test_controller.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -39,9 +39,8 @@ TEST(ControllerTests, ObjectLifecycle)
auto controller = std::make_unique<opennav_docking::Controller>(node);

geometry_msgs::msg::Pose pose;
geometry_msgs::msg::Pose robot_pose;
geometry_msgs::msg::Twist cmd_out, cmd_init;
EXPECT_TRUE(controller->computeVelocityCommand(pose, robot_pose, cmd_out));
EXPECT_TRUE(controller->computeVelocityCommand(pose, cmd_out));
EXPECT_NE(cmd_init, cmd_out);
controller.reset();
}
Expand Down

0 comments on commit 13bf10e

Please sign in to comment.