Skip to content

Commit

Permalink
fix test
Browse files Browse the repository at this point in the history
Signed-off-by: Tony Najjar <tony.najjar.1997@gmail.com>
  • Loading branch information
tonynajjar committed Sep 3, 2024
1 parent 4d2b402 commit 51f54eb
Showing 1 changed file with 4 additions and 4 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -36,18 +36,18 @@ BT::NodeStatus GoalUpdatedController::tick()
// Reset since we're starting a new iteration of
// the goal updated controller (moving from IDLE to RUNNING)

BT::getInputOrBlackboard("goals", goals_);
BT::getInputOrBlackboard("goal", goal_);
goals_ = config().blackboard->get<std::vector<geometry_msgs::msg::PoseStamped>>("goals");
goal_ = config().blackboard->get<geometry_msgs::msg::PoseStamped>("goal");

goal_was_updated_ = true;
}

setStatus(BT::NodeStatus::RUNNING);

std::vector<geometry_msgs::msg::PoseStamped> current_goals;
BT::getInputOrBlackboard("goals", current_goals);
current_goals = config().blackboard->get<std::vector<geometry_msgs::msg::PoseStamped>>("goals");
geometry_msgs::msg::PoseStamped current_goal;
BT::getInputOrBlackboard("goal", current_goal);
current_goal = config().blackboard->get<geometry_msgs::msg::PoseStamped>("goal");

if (goal_ != current_goal || goals_ != current_goals) {
goal_ = current_goal;
Expand Down

0 comments on commit 51f54eb

Please sign in to comment.