Skip to content

Commit

Permalink
uncrusify fix
Browse files Browse the repository at this point in the history
  • Loading branch information
jwallace42 committed Sep 9, 2022
1 parent c532aa9 commit 0e19268
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 2 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -64,7 +64,7 @@ class ComputePathToPoseAction : public BtActionNode<nav2_msgs::action::ComputePa
/**
* \brief Override required by the a BT action. Cancel the action and set the path output
*/
void halt() override;
void halt() override;

/**
* @brief Creates list of BT ports
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -57,7 +57,8 @@ BT::NodeStatus ComputePathToPoseAction::on_cancelled()
return BT::NodeStatus::SUCCESS;
}

void ComputePathToPoseAction::halt() {
void ComputePathToPoseAction::halt()
{
nav_msgs::msg::Path empty_path;
setOutput("path", empty_path);
BtActionNode::halt();
Expand Down

0 comments on commit 0e19268

Please sign in to comment.