Skip to content

Commit 3785515

Browse files
committed
fix format
1 parent d50b6ba commit 3785515

File tree

1 file changed

+4
-3
lines changed

1 file changed

+4
-3
lines changed

joint_trajectory_controller/test/test_trajectory_controller.cpp

Lines changed: 4 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -468,7 +468,9 @@ TEST_F(TrajectoryControllerTest, time_from_start_populated)
468468
subscribeToState(executor);
469469

470470
// schedule a single waypoint at 100ms:
471-
builtin_interfaces::msg::Duration tfs; tfs.sec = 0; tfs.nanosec = 100000000;
471+
builtin_interfaces::msg::Duration tfs;
472+
tfs.sec = 0;
473+
tfs.nanosec = 100000000;
472474
publish(tfs, {INITIAL_POS_JOINTS}, rclcpp::Time(0));
473475
traj_controller_->wait_for_trajectory(executor);
474476

@@ -478,11 +480,10 @@ TEST_F(TrajectoryControllerTest, time_from_start_populated)
478480

479481
auto state = getState();
480482
ASSERT_TRUE(state);
481-
EXPECT_EQ(state->feedback.time_from_start.sec, 0u);
483+
EXPECT_EQ(state->feedback.time_from_start.sec, 0u);
482484
EXPECT_EQ(state->feedback.time_from_start.nanosec, 100000000u);
483485
}
484486

485-
486487
/**
487488
* @brief check if dynamic parameters are updated
488489
*/

0 commit comments

Comments
 (0)