Skip to content

Commit 44e328e

Browse files
Matt HansenCarl Delsey
authored andcommitted
Fix motion primitives CI fail (#481)
* Fix motion primitives CI fail * Fixing second line failing
1 parent d876e78 commit 44e328e

File tree

1 file changed

+2
-4
lines changed

1 file changed

+2
-4
lines changed

nav2_motion_primitives/include/nav2_motion_primitives/motion_primitive.hpp

Lines changed: 2 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -79,9 +79,7 @@ class MotionPrimitive
7979
RCLCPP_INFO(node_->get_logger(), "%s attempting behavior", taskName_.c_str());
8080

8181
ResultMsg result;
82-
nav2_tasks::TaskStatus status;
83-
84-
status = onRun(command);
82+
auto status = onRun(command);
8583

8684
if (status == nav2_tasks::TaskStatus::SUCCEEDED) {
8785
status = cycle(result);
@@ -99,7 +97,7 @@ class MotionPrimitive
9997
auto start_time = std::chrono::system_clock::now();
10098
auto current_time = std::chrono::system_clock::now();
10199

102-
nav2_tasks::TaskStatus status;
100+
auto status = nav2_tasks::TaskStatus::FAILED;
103101

104102
while (rclcpp::ok()) {
105103
if (task_server_->cancelRequested()) {

0 commit comments

Comments
 (0)