File tree Expand file tree Collapse file tree 7 files changed +20
-18
lines changed
include/nav2_behavior_tree/utils Expand file tree Collapse file tree 7 files changed +20
-18
lines changed Original file line number Diff line number Diff line change @@ -223,8 +223,8 @@ install(DIRECTORY include/
223223 DESTINATION include /
224224)
225225
226- install (DIRECTORY test /utils /
227- DESTINATION include /utils/
226+ install (DIRECTORY test /include /
227+ DESTINATION include /
228228)
229229
230230install (FILES nav2_tree_nodes.xml DESTINATION share/${PROJECT_NAME} )
Original file line number Diff line number Diff line change 11ament_add_gtest(test_bt_conversions test_bt_conversions.cpp)
22ament_target_dependencies(test_bt_conversions ${dependencies} )
33
4- include_directories (.)
4+ include_directories (
5+ include /nav2_behavior_tree
6+ )
57
68add_subdirectory (plugins/condition )
79add_subdirectory (plugins/decorator)
Original file line number Diff line number Diff line change 1212// See the License for the specific language governing permissions and
1313// limitations under the License.
1414
15- #ifndef UTILS__TEST_ACTION_SERVER_HPP_
16- #define UTILS__TEST_ACTION_SERVER_HPP_
15+ #ifndef NAV2_BEHAVIOR_TREE__UTILS__TEST_ACTION_SERVER_HPP_
16+ #define NAV2_BEHAVIOR_TREE__UTILS__TEST_ACTION_SERVER_HPP_
1717
1818#include < string>
1919#include < memory>
@@ -97,4 +97,4 @@ class TestActionServer : public rclcpp::Node
9797 bool goal_cancelled_ = false ;
9898};
9999
100- #endif // UTILS__TEST_ACTION_SERVER_HPP_
100+ #endif // NAV2_BEHAVIOR_TREE__UTILS__TEST_ACTION_SERVER_HPP_
Original file line number Diff line number Diff line change 1313// See the License for the specific language governing permissions and
1414// limitations under the License.
1515
16- #ifndef UTILS__TEST_BEHAVIOR_TREE_FIXTURE_HPP_
17- #define UTILS__TEST_BEHAVIOR_TREE_FIXTURE_HPP_
16+ #ifndef NAV2_BEHAVIOR_TREE__UTILS__TEST_BEHAVIOR_TREE_FIXTURE_HPP_
17+ #define NAV2_BEHAVIOR_TREE__UTILS__TEST_BEHAVIOR_TREE_FIXTURE_HPP_
1818
1919#include < gtest/gtest.h>
2020#include < memory>
@@ -90,4 +90,4 @@ BT::NodeConfiguration * nav2_behavior_tree::BehaviorTreeTestFixture::config_ = n
9090std::shared_ptr<BT::BehaviorTreeFactory>
9191nav2_behavior_tree::BehaviorTreeTestFixture::factory_ = nullptr ;
9292
93- #endif // UTILS__TEST_BEHAVIOR_TREE_FIXTURE_HPP_
93+ #endif // NAV2_BEHAVIOR_TREE__UTILS__TEST_BEHAVIOR_TREE_FIXTURE_HPP_
Original file line number Diff line number Diff line change 1313// See the License for the specific language governing permissions and
1414// limitations under the License.
1515
16- #ifndef UTILS__TEST_DUMMY_TREE_NODE_HPP_
17- #define UTILS__TEST_DUMMY_TREE_NODE_HPP_
16+ #ifndef NAV2_BEHAVIOR_TREE__UTILS__TEST_DUMMY_TREE_NODE_HPP_
17+ #define NAV2_BEHAVIOR_TREE__UTILS__TEST_DUMMY_TREE_NODE_HPP_
1818
1919#include < behaviortree_cpp_v3/basic_types.h>
2020#include < behaviortree_cpp_v3/action_node.h>
@@ -56,4 +56,4 @@ class DummyNode : public BT::ActionNodeBase
5656
5757} // namespace nav2_behavior_tree
5858
59- #endif // UTILS__TEST_DUMMY_TREE_NODE_HPP_
59+ #endif // NAV2_BEHAVIOR_TREE__UTILS__TEST_DUMMY_TREE_NODE_HPP_
Original file line number Diff line number Diff line change 1212// See the License for the specific language governing permissions and
1313// limitations under the License.
1414
15- #ifndef UTILS__TEST_SERVICE_HPP_
16- #define UTILS__TEST_SERVICE_HPP_
15+ #ifndef NAV2_BEHAVIOR_TREE__UTILS__TEST_SERVICE_HPP_
16+ #define NAV2_BEHAVIOR_TREE__UTILS__TEST_SERVICE_HPP_
1717
1818#include < string>
1919#include < memory>
@@ -57,4 +57,4 @@ class TestService : public rclcpp::Node
5757 std::shared_ptr<typename ServiceT::Request> current_request_;
5858};
5959
60- #endif // UTILS__TEST_SERVICE_HPP_
60+ #endif // NAV2_BEHAVIOR_TREE__UTILS__TEST_SERVICE_HPP_
Original file line number Diff line number Diff line change 1313// See the License for the specific language governing permissions and
1414// limitations under the License.
1515
16- #ifndef UTILS__TEST_TRANSFORM_HANDLER_HPP_
17- #define UTILS__TEST_TRANSFORM_HANDLER_HPP_
16+ #ifndef NAV2_BEHAVIOR_TREE__UTILS__TEST_TRANSFORM_HANDLER_HPP_
17+ #define NAV2_BEHAVIOR_TREE__UTILS__TEST_TRANSFORM_HANDLER_HPP_
1818
1919#include < memory>
2020#include < string>
@@ -162,4 +162,4 @@ class TransformHandler
162162
163163} // namespace nav2_behavior_tree
164164
165- #endif // UTILS__TEST_TRANSFORM_HANDLER_HPP_
165+ #endif // NAV2_BEHAVIOR_TREE__UTILS__TEST_TRANSFORM_HANDLER_HPP_
You can’t perform that action at this time.
0 commit comments