Skip to content

Commit 7e25451

Browse files
committed
deleting python files
Signed-off-by: Haroon Rasheed <[email protected]>
1 parent 8dfd36b commit 7e25451

File tree

9 files changed

+19
-385
lines changed

9 files changed

+19
-385
lines changed

nav2_gps_waypoint_follower_demo/CMakeLists.txt

Lines changed: 1 addition & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -15,6 +15,7 @@ if(BUILD_TESTING)
1515
ament_lint_auto_find_test_dependencies()
1616
endif()
1717

18+
1819
install(DIRECTORY worlds models launch urdf config
1920
DESTINATION share/${PROJECT_NAME}/
2021
)

nav2_gps_waypoint_follower_demo/config/behavior.xml

Lines changed: 0 additions & 28 deletions
This file was deleted.

nav2_gps_waypoint_follower_demo/config/demo_waypoints.yaml

Lines changed: 0 additions & 13 deletions
This file was deleted.

nav2_gps_waypoint_follower_demo/config/nav2_no_map_params.yaml

Lines changed: 18 additions & 50 deletions
Original file line numberDiff line numberDiff line change
@@ -6,61 +6,29 @@
66

77
bt_navigator:
88
ros__parameters:
9-
use_sim_time: True
109
global_frame: map
1110
robot_base_frame: base_link
1211
odom_topic: /odom
1312
bt_loop_duration: 10
1413
default_server_timeout: 20
15-
default_nav_to_pose_bt_xml: "/home/haroon/ros2_ws/src/navigation2_tutorials/nav2_gps_waypoint_follower_demo/config/behavior.xml"
16-
plugin_lib_names:
17-
- nav2_compute_path_to_pose_action_bt_node
18-
- nav2_compute_path_through_poses_action_bt_node
19-
- nav2_smooth_path_action_bt_node
20-
- nav2_follow_path_action_bt_node
21-
- nav2_spin_action_bt_node
22-
- nav2_wait_action_bt_node
23-
- nav2_back_up_action_bt_node
24-
- nav2_drive_on_heading_bt_node
25-
- nav2_clear_costmap_service_bt_node
26-
- nav2_is_stuck_condition_bt_node
27-
- nav2_goal_reached_condition_bt_node
28-
- nav2_goal_updated_condition_bt_node
29-
- nav2_globally_updated_goal_condition_bt_node
30-
- nav2_is_path_valid_condition_bt_node
31-
- nav2_initial_pose_received_condition_bt_node
32-
- nav2_reinitialize_global_localization_service_bt_node
33-
- nav2_rate_controller_bt_node
34-
- nav2_distance_controller_bt_node
35-
- nav2_speed_controller_bt_node
36-
- nav2_truncate_path_action_bt_node
37-
- nav2_truncate_path_local_action_bt_node
38-
- nav2_goal_updater_node_bt_node
39-
- nav2_recovery_node_bt_node
40-
- nav2_pipeline_sequence_bt_node
41-
- nav2_round_robin_node_bt_node
42-
- nav2_transform_available_condition_bt_node
43-
- nav2_time_expired_condition_bt_node
44-
- nav2_path_expiring_timer_condition
45-
- nav2_distance_traveled_condition_bt_node
46-
- nav2_single_trigger_bt_node
47-
- nav2_goal_updated_controller_bt_node
48-
- nav2_is_battery_low_condition_bt_node
49-
- nav2_navigate_through_poses_action_bt_node
50-
- nav2_navigate_to_pose_action_bt_node
51-
- nav2_remove_passed_goals_action_bt_node
52-
- nav2_planner_selector_bt_node
53-
- nav2_controller_selector_bt_node
54-
- nav2_goal_checker_selector_bt_node
55-
- nav2_controller_cancel_bt_node
56-
- nav2_path_longer_on_approach_bt_node
57-
- nav2_wait_cancel_bt_node
58-
- nav2_spin_cancel_bt_node
59-
- nav2_back_up_cancel_bt_node
60-
- nav2_drive_on_heading_cancel_bt_node
61-
error_code_names:
62-
- compute_path_error_code
63-
- follow_path_error_code
14+
wait_for_service_timeout: 1000
15+
navigators: ["navigate_to_pose", "navigate_through_poses"]
16+
navigate_to_pose:
17+
plugin: "nav2_bt_navigator::NavigateToPoseNavigator"
18+
navigate_through_poses:
19+
plugin: "nav2_bt_navigator::NavigateThroughPosesNavigator"
20+
# 'default_nav_through_poses_bt_xml' and 'default_nav_to_pose_bt_xml' are use defaults:
21+
# nav2_bt_navigator/navigate_to_pose_w_replanning_and_recovery.xml
22+
# nav2_bt_navigator/navigate_through_poses_w_replanning_and_recovery.xml
23+
# They can be set here or via a RewrittenYaml remap from a parent launch file to Nav2.
24+
25+
# plugin_lib_names is used to add custom BT plugins to the executor (vector of strings).
26+
# Built-in plugins are added automatically
27+
# plugin_lib_names: []
28+
29+
error_code_name_prefixes:
30+
- compute_path
31+
- follow_path
6432

6533
controller_server:
6634
ros__parameters:

nav2_gps_waypoint_follower_demo/nav2_gps_waypoint_follower_demo/gps_waypoint_logger.py

Lines changed: 0 additions & 128 deletions
This file was deleted.

nav2_gps_waypoint_follower_demo/nav2_gps_waypoint_follower_demo/interactive_waypoint_follower.py

Lines changed: 0 additions & 43 deletions
This file was deleted.

nav2_gps_waypoint_follower_demo/nav2_gps_waypoint_follower_demo/logged_waypoint_follower.py

Lines changed: 0 additions & 69 deletions
This file was deleted.

nav2_gps_waypoint_follower_demo/nav2_gps_waypoint_follower_demo/utils/__init__.py

Whitespace-only changes.

0 commit comments

Comments
 (0)