Skip to content

Commit cf6acf8

Browse files
shivaang12AlexeyMerzlyakov
authored andcommitted
Refactor rclcpp::executor::FutureReturnCode deprecation (ros-navigation#1702)
* Refactor deprecated code * Add ompl repo (for test) * Fix indent * Remove OMPL
1 parent bcc8ba9 commit cf6acf8

File tree

1 file changed

+3
-3
lines changed

1 file changed

+3
-3
lines changed

‎nav2_behavior_tree/include/nav2_behavior_tree/bt_service_node.hpp‎

Lines changed: 3 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -98,13 +98,13 @@ class BtServiceNode : public BT::SyncActionNode
9898
virtual BT::NodeStatus check_future(
9999
std::shared_future<typename ServiceT::Response::SharedPtr> future_result)
100100
{
101-
rclcpp::executor::FutureReturnCode rc;
101+
rclcpp::FutureReturnCode rc;
102102
rc = rclcpp::spin_until_future_complete(
103103
node_,
104104
future_result, server_timeout_);
105-
if (rc == rclcpp::executor::FutureReturnCode::SUCCESS) {
105+
if (rc == rclcpp::FutureReturnCode::SUCCESS) {
106106
return BT::NodeStatus::SUCCESS;
107-
} else if (rc == rclcpp::executor::FutureReturnCode::TIMEOUT) {
107+
} else if (rc == rclcpp::FutureReturnCode::TIMEOUT) {
108108
RCLCPP_WARN(
109109
node_->get_logger(),
110110
"Node timed out while executing service call to %s.", service_name_.c_str());

0 commit comments

Comments
 (0)