File tree Expand file tree Collapse file tree 2 files changed +2
-3
lines changed
include/nav2_behavior_tree/plugins/decorator Expand file tree Collapse file tree 2 files changed +2
-3
lines changed Original file line number Diff line number Diff line change 19
19
20
20
#include < memory>
21
21
#include < string>
22
- #include < vector>
23
22
24
23
#include " geometry_msgs/msg/pose_stamped.hpp"
25
24
#include " geometry_msgs/msg/pose_stamped_array.hpp"
@@ -78,7 +77,7 @@ class GoalUpdater : public BT::DecoratorNode
78
77
79
78
/* *
80
79
* @brief Callback function for goals update topic
81
- * @param msg Shared pointer to vector of geometry_msgs::msg::PoseStamped message
80
+ * @param msg Shared pointer to geometry_msgs::msg::PoseStampedArray message
82
81
*/
83
82
void callback_updated_goals (const geometry_msgs::msg::PoseStampedArray::SharedPtr msg);
84
83
Original file line number Diff line number Diff line change @@ -99,7 +99,7 @@ inline BT::NodeStatus GoalUpdater::tick()
99
99
auto last_goals_received_time = rclcpp::Time (last_goals_received_.header .stamp );
100
100
auto goals_time = rclcpp::Time (goals.header .stamp );
101
101
if (last_goals_received_time > goals_time) {
102
- setOutput (" output_goals" , last_goals_received_. poses );
102
+ setOutput (" output_goals" , last_goals_received_);
103
103
} else {
104
104
RCLCPP_WARN (
105
105
node_->get_logger (), " The timestamp of the received goals (%f) is older than the "
You can’t perform that action at this time.
0 commit comments