Ros2 navigation galactic: path planning not working and time problems

Hello there,

can somebody explain me why my rosject is not working please? I had everything done and working with foxy but after 2 monthes without touching it didn’t work properly and gave an the fail of the subject of this quote where the only solution is to update to galactic.

The course was in galactic so in principle it had to be easier to do redo it as there aren’t changes to do to adapt the course code like when I did it in foxy.

Here come what I have and the questions are in bold

Localisation part

user:~/ros2_ws$ ros2 launch project_localization localization.launch.py[INFO] [launch]: All log files can be found below /home/user/.ros/log/2023-11-27-16-23-16-863296-2_xterm-6990
[INFO] [launch]: Default logging verbosity is set to INFO
[INFO] [map_server-1]: process started with pid [7004]
[INFO] [amcl-2]: process started with pid [7007]
[INFO] [lifecycle_manager-3]: process started with pid [7009]
[map_server-1] [INFO] [1701102197.750082165] [map_server]:
[map_server-1]  map_server lifecycle node launched.
[map_server-1]  Waiting on external lifecycle transitions to activate
[map_server-1]  See https://design.ros2.org/articles/node_lifecycle.html for more information.
[map_server-1] [INFO] [1701102197.750207997] [map_server]: Creating
[lifecycle_manager-3] [INFO] [1701102197.759298436] [lifecycle_manager_localization]: Creating
[amcl-2] [INFO] [1701102197.759855358] [amcl]:
[amcl-2]        amcl lifecycle node launched.
[amcl-2]        Waiting on external lifecycle transitions to activate
[amcl-2]        See https://design.ros2.org/articles/node_lifecycle.html for more information.
[amcl-2] [INFO] [1701102197.760064594] [amcl]: Creating
[lifecycle_manager-3] [INFO] [1701102197.834682974] [lifecycle_manager_localization]: Creating and initializing lifecycle service clients
[lifecycle_manager-3] [INFO] [1701102198.031100091] [lifecycle_manager_localization]: Starting managed nodes bringup...
[lifecycle_manager-3] [INFO] [1701102198.031215887] [lifecycle_manager_localization]: Configuring map_server
[map_server-1] [INFO] [1701102198.031697926] [map_server]: Configuring
[map_server-1] [INFO] [map_io]: Loading yaml file: /home/user/ros2_ws/install/project_mapping/share/project_mapping/maps/turtlebot_area.yaml
[map_server-1] [DEBUG] [map_io]: resolution: 0.05
[map_server-1] [DEBUG] [map_io]: origin[0]: -1.26
[map_server-1] [DEBUG] [map_io]: origin[1]: -1.84
[map_server-1] [DEBUG] [map_io]: origin[2]: 0
[map_server-1] [DEBUG] [map_io]: free_thresh: 0.25
[map_server-1] [DEBUG] [map_io]: occupied_thresh: 0.65
[map_server-1] [DEBUG] [map_io]: mode: trinary
[map_server-1] [DEBUG] [map_io]: negate: 0
[map_server-1] [INFO] [map_io]: Loading image_file: /home/user/ros2_ws/install/project_mapping/share/project_mapping/maps/turtlebot_area.pgm
[map_server-1] [DEBUG] [map_io]: Read map /home/user/ros2_ws/install/project_mapping/share/project_mapping/maps/turtlebot_area.pgm: 55 X 50 map @ 0.05 m/cell
[lifecycle_manager-3] [INFO] [1701102198.209938303] [lifecycle_manager_localization]: Configuring amcl
[amcl-2] [INFO] [1701102198.210365662] [amcl]: Configuring
[amcl-2] [INFO] [1701102198.210504575] [amcl]: initTransforms
[amcl-2] [INFO] [1701102198.225461745] [amcl]: initPubSub
[amcl-2] [INFO] [1701102198.230316616] [amcl]: Subscribed to map topic.
[lifecycle_manager-3] [INFO] [1701102198.320123606] [lifecycle_manager_localization]: Activating map_server
[map_server-1] [INFO] [1701102198.320410457] [map_server]: Activating
[map_server-1] [INFO] [1701102198.320618926] [map_server]: Creating bond (map_server) to lifecycle manager.
[amcl-2] [INFO] [1701102198.320627485] [amcl]: Received a 55 X 50 map @ 0.050 m/pix
[lifecycle_manager-3] [INFO] [1701102198.695787606] [lifecycle_manager_localization]: Server map_server connected with bond.
[lifecycle_manager-3] [INFO] [1701102198.695860745] [lifecycle_manager_localization]: Activating amcl
[amcl-2] [INFO] [1701102198.696333494] [amcl]: Activating
[amcl-2] [INFO] [1701102198.696386685] [amcl]: initialPoseReceived
[amcl-2] [INFO] [1701102198.696578734] [amcl]: Setting pose (10.205000): 0.000 0.000 0.000
[amcl-2] [INFO] [1701102198.699812081] [amcl]: Creating bond (amcl) tolifecycle manager.
[amcl-2] [INFO] [1701102198.777399888] [amcl]: createLaserObject
[lifecycle_manager-3] [INFO] [1701102198.968961591] [lifecycle_manager_localization]: Server amcl connected with bond.
[lifecycle_manager-3] [INFO] [1701102198.969034693] [lifecycle_manager_localization]: Managed nodes are active
[lifecycle_manager-3] [INFO] [1701102198.969056540] [lifecycle_manager_localization]: Creating bond timer...
[amcl-2] [INFO] [1701102223.353853967] [amcl]: initialPoseReceived
[amcl-2] [WARN] [1701102223.353994610] [amcl]: Failed to transform initial pose in time (Lookup would require extrapolation into the future.Requested time 1701102223.353592 but the latest data is at time 23.359000, when looking up transform from frame [odom] to frame [base_footprint])
[amcl-2] [INFO] [1701102223.354022751] [amcl]: Setting pose (23.197000): -0.018 0.013 -0.016

is the warning normal? I used to have this warning with a times really close but now it is ridiculously different.
if it isn’t a problem I have the localisation part working properly as you can see in the following pictures.

after launching localization and giving an estimate pose
image
after spinning

amcl_config.yaml

amcl:
  ros__parameters:
    use_sim_time: True
    alpha1: 0.2
    alpha2: 0.2
    alpha3: 0.2
    alpha4: 0.2
    alpha5: 0.2
    base_frame_id: "base_footprint"
    beam_skip_distance: 0.5
    beam_skip_error_threshold: 0.9
    beam_skip_threshold: 0.3
    do_beamskip: false
    global_frame_id: "map"
    lambda_short: 0.1
    laser_likelihood_max_dist: 2.0
    laser_max_range: 100.0
    laser_min_range: -1.0
    laser_model_type: "likelihood_field"
    max_beams: 60
    max_particles: 8000
    min_particles: 200
    odom_frame_id: "odom"
    pf_err: 0.05
    pf_z: 0.99
    recovery_alpha_fast: 0.0
    recovery_alpha_slow: 0.0
    resample_interval: 1
    robot_model_type: "differential"
    save_pose_rate: 0.5
    sigma_hit: 0.2
    tf_broadcast: true
    transform_tolerance: 0.5
    update_min_a: 0.05
    update_min_d: 0.1
    z_hit: 0.5
    z_max: 0.05
    z_rand: 0.5
    z_short: 0.05
    set_initial_pose: true
    initial_pose: 
        x: 0.0
        y: 0.0
        yaw: 0.0

localization.launch

import os

from ament_index_python.packages import get_package_share_directory
from launch import LaunchDescription
from launch_ros.actions import Node

def generate_launch_description():
    
    nav2_yaml = os.path.join(get_package_share_directory('project_localization'), 'config', 'amcl_config.yaml')
    map_file = os.path.join(get_package_share_directory('project_mapping'), 'maps', 'turtlebot_area.yaml')

    return LaunchDescription([
        Node(
            package='nav2_map_server',
            executable='map_server',
            name='map_server',
            output='screen',
            parameters=[{'use_sim_time': True}, 
                        {'yaml_filename':map_file}]
        ),
            
        Node(
            package='nav2_amcl',
            executable='amcl',
            name='amcl',
            output='screen',
            parameters=[nav2_yaml]
        ),

        Node(
            package='nav2_lifecycle_manager',
            executable='lifecycle_manager',
            name='lifecycle_manager_localization',
            output='screen',
            parameters=[{'use_sim_time': True},
                        {'autostart': True},
                        {'node_names': ['map_server', 'amcl']}]
        )
    ])

Path planning part

after launching path planning

user:~/ros2_ws$ ros2 launch project_path_planning pathplanner.launch.py[INFO] [launch]: All log files can be found below /home/user/.ros/log/2023-11-27-16-27-14-401088-2_xterm-8533
[INFO] [launch]: Default logging verbosity is set to INFO
[INFO] [controller_server-1]: process started with pid [8538]
[INFO] [planner_server-2]: process started with pid [8540]
[INFO] [recoveries_server-3]: process started with pid [8547]
[INFO] [bt_navigator-4]: process started with pid [8559]
[INFO] [lifecycle_manager-5]: process started with pid [8562]
[controller_server-1] [INFO] [1701102435.799459925] [controller_server]:
[controller_server-1]   controller_server lifecycle node launched.
[controller_server-1]   Waiting on external lifecycle transitions to activate
[controller_server-1]   See https://design.ros2.org/articles/node_lifecycle.html for more information.
[recoveries_server-3] [INFO] [1701102435.814105312] [recoveries_server]:
[recoveries_server-3]   recoveries_server lifecycle node launched.
[recoveries_server-3]   Waiting on external lifecycle transitions to activate
[recoveries_server-3]   See https://design.ros2.org/articles/node_lifecycle.html for more information.
[planner_server-2] [INFO] [1701102435.816683643] [planner_server]:
[planner_server-2]      planner_server lifecycle node launched.
[planner_server-2]      Waiting on external lifecycle transitions to activate
[planner_server-2]      See https://design.ros2.org/articles/node_lifecycle.html for more information.
[planner_server-2] [INFO] [1701102435.825755782] [planner_server]: Creating
[controller_server-1] [INFO] [1701102435.909379642] [controller_server]: Creating controller server
[planner_server-2] [INFO] [1701102435.923603713] [global_costmap.global_costmap]:
[planner_server-2]      global_costmap lifecycle node launched.
[planner_server-2]      Waiting on external lifecycle transitions to activate
[planner_server-2]      See https://design.ros2.org/articles/node_lifecycle.html for more information.
[planner_server-2] [INFO] [1701102435.925819501] [global_costmap.global_costmap]: Creating Costmap
[bt_navigator-4] [INFO] [1701102435.924430741] [bt_navigator]:
[bt_navigator-4]        bt_navigator lifecycle node launched.
[bt_navigator-4]        Waiting on external lifecycle transitions to activate
[bt_navigator-4]        See https://design.ros2.org/articles/node_lifecycle.html for more information.
[bt_navigator-4] [INFO] [1701102435.924548396] [bt_navigator]: Creating
[lifecycle_manager-5] [INFO] [1701102435.993947820] [lifecycle_manager_pathplanner]: Creating
[lifecycle_manager-5] [INFO] [1701102436.096272393] [lifecycle_manager_pathplanner]: Creating and initializing lifecycle service clients
[controller_server-1] [INFO] [1701102436.102777856] [local_costmap.local_costmap]:
[controller_server-1]   local_costmap lifecycle node launched.
[controller_server-1]   Waiting on external lifecycle transitions to activate
[controller_server-1]   See https://design.ros2.org/articles/node_lifecycle.html for more information.
[lifecycle_manager-5] [INFO] [1701102436.184524920] [lifecycle_manager_pathplanner]: Starting managed nodes bringup...
[lifecycle_manager-5] [INFO] [1701102436.184600092] [lifecycle_manager_pathplanner]: Configuring planner_server
[controller_server-1] [INFO] [1701102436.188041398] [local_costmap.local_costmap]: Creating Costmap
[planner_server-2] [INFO] [1701102436.369151033] [planner_server]: Configuring
[planner_server-2] [INFO] [1701102436.369280253] [global_costmap.global_costmap]: Configuring
[planner_server-2] [INFO] [1701102436.375039772] [global_costmap.global_costmap]: Using plugin "static_layer"
[planner_server-2] [INFO] [1701102436.385998453] [global_costmap.global_costmap]: Subscribing to the map topic (/map) with transient local durability
[planner_server-2] [INFO] [1701102436.388058812] [global_costmap.global_costmap]: Initialized plugin "static_layer"
[planner_server-2] [INFO] [1701102436.388097864] [global_costmap.global_costmap]: Using plugin "inflation_layer"
[planner_server-2] [INFO] [1701102436.390765742] [global_costmap.global_costmap]: Initialized plugin "inflation_layer"
[planner_server-2] [INFO] [1701102436.398182848] [planner_server]: Created global planner plugin GridBased of type nav2_navfn_planner/NavfnPlanner
[planner_server-2] [INFO] [1701102436.398235711] [planner_server]: Configuring plugin GridBased of type NavfnPlanner
[planner_server-2] [INFO] [1701102436.400451179] [planner_server]: Planner Server has GridBased  planners available.
[lifecycle_manager-5] [INFO] [1701102436.647213333] [lifecycle_manager_pathplanner]: Configuring controller_server
[planner_server-2] [INFO] [1701102436.648611676] [global_costmap.global_costmap]: StaticLayer: Resizing costmap to 55 X 50 at 0.050000 m/pix
[controller_server-1] [INFO] [1701102436.648635487] [controller_server]: Configuring controller interface
[controller_server-1] [INFO] [1701102436.648837651] [controller_server]: getting goal checker plugins..
[controller_server-1] [INFO] [1701102436.648966931] [controller_server]: Controller frequency set to 10.0000Hz
[controller_server-1] [INFO] [1701102436.648997659] [local_costmap.local_costmap]: Configuring
[controller_server-1] [INFO] [1701102436.653217190] [local_costmap.local_costmap]: Using plugin "voxel_layer"
[controller_server-1] [INFO] [1701102436.659885276] [local_costmap.local_costmap]: Subscribed to Topics: scan
[controller_server-1] [INFO] [1701102436.747897456] [local_costmap.local_costmap]: Initialized plugin "voxel_layer"
[controller_server-1] [INFO] [1701102436.747954145] [local_costmap.local_costmap]: Using plugin "inflation_layer"
[controller_server-1] [INFO] [1701102436.750499778] [local_costmap.local_costmap]: Initialized plugin "inflation_layer"
[controller_server-1] [INFO] [1701102436.758292621] [controller_server]: Created progress_checker : progress_checker of type nav2_controller::SimpleProgressChecker
[controller_server-1] [INFO] [1701102436.855504193] [controller_server]: Created goal checker : general_goal_checker of type nav2_controller::SimpleGoalChecker
[controller_server-1] [INFO] [1701102436.860154062] [controller_server]: Controller Server has general_goal_checker  goal checkers available.
[controller_server-1] [INFO] [1701102436.868714756] [controller_server]: Created controller : FollowPath of type dwb_core::DWBLocalPlanner
[controller_server-1] [INFO] [1701102436.872605953] [controller_server]: Setting transform_tolerance to 0.200000
[controller_server-1] [INFO] [1701102436.888424873] [controller_server]: Using critic "RotateToGoal" (dwb_critics::RotateToGoalCritic)
[controller_server-1] [INFO] [1701102436.888835758] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701102436.888957763] [controller_server]: Using critic "Oscillation" (dwb_critics::OscillationCritic)
[controller_server-1] [INFO] [1701102436.889257870] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701102436.889369933] [controller_server]: Using critic "BaseObstacle" (dwb_critics::BaseObstacleCritic)
[controller_server-1] [INFO] [1701102436.889554549] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701102436.889670457] [controller_server]: Using critic "GoalAlign" (dwb_critics::GoalAlignCritic)
[controller_server-1] [INFO] [1701102436.889946694] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701102436.890056361] [controller_server]: Using critic "PathAlign" (dwb_critics::PathAlignCritic)
[controller_server-1] [INFO] [1701102436.890288849] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701102436.890396777] [controller_server]: Using critic "PathDist" (dwb_critics::PathDistCritic)
[controller_server-1] [INFO] [1701102436.890580179] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701102436.890670731] [controller_server]: Using critic "GoalDist" (dwb_critics::GoalDistCritic)
[controller_server-1] [INFO] [1701102436.890843430] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701102436.890861715] [controller_server]: Controller Server has FollowPath  controllers available.
[lifecycle_manager-5] [INFO] [1701102437.027237167] [lifecycle_manager_pathplanner]: Configuring recoveries_server
[recoveries_server-3] [INFO] [1701102437.028001256] [recoveries_server]: Configuring
[recoveries_server-3] [INFO] [1701102437.037816471] [recoveries_server]: Creating recovery plugin spin of type nav2_recoveries/Spin
[recoveries_server-3] [INFO] [1701102437.040002919] [recoveries_server]: Configuring spin
[recoveries_server-3] [INFO] [1701102437.051965433] [recoveries_server]: Creating recovery plugin backup of type nav2_recoveries/BackUp
[recoveries_server-3] [INFO] [1701102437.055387818] [recoveries_server]: Configuring backup
[recoveries_server-3] [INFO] [1701102437.200777436] [recoveries_server]: Creating recovery plugin wait of type nav2_recoveries/Wait
[recoveries_server-3] [INFO] [1701102437.205581307] [recoveries_server]: Configuring wait
[lifecycle_manager-5] [INFO] [1701102437.396370233] [lifecycle_manager_pathplanner]: Configuring bt_navigator
[bt_navigator-4] [INFO] [1701102437.397007433] [bt_navigator]: Configuring
[lifecycle_manager-5] [INFO] [1701102437.670020742] [lifecycle_manager_pathplanner]: Activating planner_server
[planner_server-2] [INFO] [1701102437.670437465] [planner_server]: Activating
[planner_server-2] [INFO] [1701102437.670482921] [global_costmap.global_costmap]: Activating
[planner_server-2] [INFO] [1701102437.670503938] [global_costmap.global_costmap]: Checking transform
[planner_server-2] [INFO] [1701102437.670613441] [global_costmap.global_costmap]: Timed out waiting for transform from base_link to map to become available, tf error: Lookup would require extrapolation into the past.  Requested time 129.813000 but the earliest data is at time 129.832000, when looking up transform from frame [base_link] to frame [map]
[planner_server-2] [INFO] [1701102438.235534273] [global_costmap.global_costmap]: start
[planner_server-2] [INFO] [1701102438.328678271] [planner_server]: Activating plugin GridBased of type NavfnPlanner
[planner_server-2] [INFO] [1701102438.328785609] [planner_server]: Creating bond (planner_server) to lifecycle manager.
[lifecycle_manager-5] [INFO] [1701102438.603709558] [lifecycle_manager_pathplanner]: Server planner_server connected with bond.
[lifecycle_manager-5] [INFO] [1701102438.603782237] [lifecycle_manager_pathplanner]: Activating controller_server
[controller_server-1] [INFO] [1701102438.696722346] [controller_server]: Activating
[controller_server-1] [INFO] [1701102438.698826250] [local_costmap.local_costmap]: Activating
[controller_server-1] [INFO] [1701102438.698888468] [local_costmap.local_costmap]: Checking transform
[controller_server-1] [INFO] [1701102438.699014619] [local_costmap.local_costmap]: start
[controller_server-1] [INFO] [1701102438.793968110] [controller_server]: Creating bond (controller_server) to lifecycle manager.
[lifecycle_manager-5] [INFO] [1701102439.088167055] [lifecycle_manager_pathplanner]: Server controller_server connected with bond.
[lifecycle_manager-5] [INFO] [1701102439.088233459] [lifecycle_manager_pathplanner]: Activating recoveries_server
[recoveries_server-3] [INFO] [1701102439.090235490] [recoveries_server]: Activating
[recoveries_server-3] [INFO] [1701102439.090280044] [recoveries_server]: Activating spin
[recoveries_server-3] [INFO] [1701102439.090296042] [recoveries_server]: Activating backup
[recoveries_server-3] [INFO] [1701102439.090311456] [recoveries_server]: Activating wait
[recoveries_server-3] [INFO] [1701102439.090325692] [recoveries_server]: Creating bond (recoveries_server) to lifecycle manager.
[lifecycle_manager-5] [INFO] [1701102439.472177449] [lifecycle_manager_pathplanner]: Server recoveries_server connected with bond.
[lifecycle_manager-5] [INFO] [1701102439.472245153] [lifecycle_manager_pathplanner]: Activating bt_navigator
[bt_navigator-4] [INFO] [1701102439.539512986] [bt_navigator]: Activating
[bt_navigator-4] [PublisherZMQ] Publisher quitting.
[bt_navigator-4] [PublisherZMQ] just died. Exeption Context was terminated
[bt_navigator-4] [INFO] [1701102439.662103554] [bt_navigator]: Creating bond (bt_navigator) to lifecycle manager.
[lifecycle_manager-5] [INFO] [1701102439.916034887] [lifecycle_manager_pathplanner]: Server bt_navigator connected with bond.
[lifecycle_manager-5] [INFO] [1701102439.917419046] [lifecycle_manager_pathplanner]: Managed nodes are active
[lifecycle_manager-5] [INFO] [1701102439.917452188] [lifecycle_manager_pathplanner]: Creating bond timer...
[controller_server-1] [INFO] [1701102448.835714802] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 135.151 for reason 'the timestamp on the message is earlier than all the data in the transform cache'
[controller_server-1] [INFO] [1701102450.336613237] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 135.785 for reason 'the timestamp on the message is earlier than all the data in the transform cache'
[controller_server-1] [INFO] [1701102451.461964470] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 136.195 for reason 'the timestamp on the message is earlier than all the data in the transform cache'
[controller_server-1] [INFO] [1701102458.231295220] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 139.258 for reason 'the timestamp on the message is earlier than all the data in the transform cache'
[controller_server-1] [INFO] [1701102467.348790425] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 143.877 for reason 'the timestamp on the message is earlier than all the data in the transform cache'
[controller_server-1] [INFO] [1701102471.940476429] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 146.544 for reason 'the timestamp on the message is earlier than all the data in the transform cache'

I receive periodically the message filter dropping messages for the local costmap.
Is it normal? does it have an impact on how it works?

after giving a goal pose

it never moves except for spinning. it always says it timed out and does the recovery spin.
What am I doing wrong? Have I missed something passing my code from foxy to galactic?

path planning terminal

[bt_navigator-4] [INFO] [1701102912.039023972] [bt_navigator]: Begin navigating from current location to (0.43, -0.06)
[bt_navigator-4] [WARN] [1701102912.126806438] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701102912.127463853] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[controller_server-1] [INFO] [1701102912.408027438] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 358.180 for reason 'the timestamp on the message is earlier than all the data in the transform cache'
[bt_navigator-4] [WARN] [1701102912.517361492] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[controller_server-1] [INFO] [1701102912.518664443] [local_costmap.local_costmap]: Received request to clear entirely the local_costmap
[planner_server-2] [INFO] [1701102912.691630008] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[recoveries_server-3] [INFO] [1701102912.703751736] [recoveries_server]: Attempting spin
[recoveries_server-3] [INFO] [1701102912.703936520] [recoveries_server]: Turning 1.57 for spin recovery.
[bt_navigator-4] [WARN] [1701102912.798021530] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for spin
[bt_navigator-4] [ERROR] [1701102912.889388274] [bt_navigator]: Goal failed
[bt_navigator-4] [WARN] [1701102912.889453132] [bt_navigator]: [navigate_to_pose] [ActionServer] Aborting handle.

Thank you in advance

I put the rest o the elemets in a following answer to alleviate the message.

path_planner.launch

import os
from ament_index_python.packages import get_package_share_directory
from launch import LaunchDescription
from launch_ros.actions import Node

def generate_launch_description():

    controller_yaml = os.path.join(get_package_share_directory('project_path_planning'), 'config', 'controller.yaml')
    bt_navigator_yaml = os.path.join(get_package_share_directory('project_path_planning'), 'config', 'bt_navigator.yaml')
    planner_yaml = os.path.join(get_package_share_directory('project_path_planning'), 'config', 'planner_server.yaml')
    recovery_yaml = os.path.join(get_package_share_directory('project_path_planning'), 'config', 'recovery.yaml')

    
    return LaunchDescription([     
        Node(
            package='nav2_controller',
            executable='controller_server',
            name='controller_server',
            output='screen',
            parameters=[controller_yaml]),

        Node(
            package='nav2_planner',
            executable='planner_server',
            name='planner_server',
            output='screen',
            parameters=[planner_yaml]),
            
        Node(
            package='nav2_recoveries',
            executable='recoveries_server',
            name='recoveries_server',
            parameters=[recovery_yaml],
            output='screen'),

        Node(
            package='nav2_bt_navigator',
            executable='bt_navigator',
            name='bt_navigator',
            output='screen',
            parameters=[bt_navigator_yaml]),

        Node(
            package='nav2_lifecycle_manager',
            executable='lifecycle_manager',
            name='lifecycle_manager_pathplanner',
            output='screen',
            parameters=[{'autostart': True},
                        {'node_names': ['planner_server',
                                        'controller_server',
                                        'recoveries_server',
                                        'bt_navigator']}])
    ])

behaviour.xml

<root main_tree_to_execute="MainTree">
  <BehaviorTree ID="MainTree">
    <RecoveryNode number_of_retries="6" name="NavigateRecovery">
      <PipelineSequence name="NavigateWithReplanning">
        <RateController hz="1.0">
          <RecoveryNode number_of_retries="1" name="ComputePathToPose">
            <ComputePathToPose goal="{goal}" path="{path}" planner_id="GridBased"/>
            <ClearEntireCostmap service_name="global_costmap/clear_entirely_global_costmap"/>
          </RecoveryNode>
        </RateController>
        <RecoveryNode number_of_retries="1" name="FollowPath">
          <FollowPath path="{path}" controller_id="FollowPath"/>
          <ClearEntireCostmap service_name="local_costmap/clear_entirely_local_costmap"/>
        </RecoveryNode>
      </PipelineSequence>
      <SequenceStar name="RecoveryActions">
        <ClearEntireCostmap service_name="local_costmap/clear_entirely_local_costmap"/>
        <ClearEntireCostmap service_name="global_costmap/clear_entirely_global_costmap"/>
        <Spin spin_dist="1.57"/>
        <Wait wait_duration="5"/>
      </SequenceStar>
    </RecoveryNode>
  </BehaviorTree>
</root>

bt_navigator.yaml

bt_navigator:
  ros__parameters:
    use_sim_time: True
    global_frame: map
    robot_base_frame: base_link
    odom_topic: /odom
    bt_loop_duration: 10
    default_server_timeout: 20
    default_nav_to_pose_bt_xml: "/home/user/ros2_ws/src/project_path_planning/config/behavior.xml"    
    plugin_lib_names:
    - nav2_compute_path_to_pose_action_bt_node
    - nav2_compute_path_through_poses_action_bt_node
    - nav2_follow_path_action_bt_node
    - nav2_back_up_action_bt_node
    - nav2_spin_action_bt_node
    - nav2_wait_action_bt_node
    - nav2_clear_costmap_service_bt_node
    - nav2_is_stuck_condition_bt_node
    - nav2_goal_reached_condition_bt_node
    - nav2_goal_updated_condition_bt_node
    - nav2_initial_pose_received_condition_bt_node
    - nav2_reinitialize_global_localization_service_bt_node
    - nav2_rate_controller_bt_node
    - nav2_distance_controller_bt_node
    - nav2_speed_controller_bt_node
    - nav2_truncate_path_action_bt_node
    - nav2_goal_updater_node_bt_node
    - nav2_recovery_node_bt_node
    - nav2_pipeline_sequence_bt_node
    - nav2_round_robin_node_bt_node
    - nav2_transform_available_condition_bt_node
    - nav2_time_expired_condition_bt_node
    - nav2_distance_traveled_condition_bt_node
    - nav2_single_trigger_bt_node
    - nav2_is_battery_low_condition_bt_node
    - nav2_navigate_through_poses_action_bt_node
    - nav2_navigate_to_pose_action_bt_node
    - nav2_remove_passed_goals_action_bt_node

controller.yaml

controller_server:
  ros__parameters:
    use_sim_time: True
    controller_frequency: 10.0
    min_x_velocity_threshold: 0.001
    min_y_velocity_threshold: 0.5
    min_theta_velocity_threshold: 0.001
    failure_tolerance: 0.3
    progress_checker_plugin: "progress_checker"
    goal_checker_plugins: ["general_goal_checker"] 
    controller_plugins: ["FollowPath"]

    # Progress checker parameters
    progress_checker:
      plugin: "nav2_controller::SimpleProgressChecker"
      required_movement_radius: 0.5
      movement_time_allowance: 10.0
    # Goal checker parameters
    general_goal_checker:
      stateful: True
      plugin: "nav2_controller::SimpleGoalChecker"
      xy_goal_tolerance: 0.25
      yaw_goal_tolerance: 0.25
    # DWB parameters
    FollowPath:
      plugin: "dwb_core::DWBLocalPlanner"
      debug_trajectory_details: True
      min_vel_x: 0.0
      min_vel_y: 0.0
      max_vel_x: 0.26
      max_vel_y: 0.0
      max_vel_theta: 1.0
      min_speed_xy: 0.0
      max_speed_xy: 0.26
      min_speed_theta: 0.0
      acc_lim_x: 2.5
      acc_lim_y: 0.0
      acc_lim_theta: 3.2
      decel_lim_x: -2.5
      decel_lim_y: 0.0
      decel_lim_theta: -3.2
      vx_samples: 20
      vy_samples: 5
      vtheta_samples: 20
      sim_time: 1.7
      linear_granularity: 0.05
      angular_granularity: 0.025
      transform_tolerance: 0.2
      xy_goal_tolerance: 0.25
      trans_stopped_velocity: 0.25
      short_circuit_trajectory_evaluation: True
      stateful: True
      critics: ["RotateToGoal", "Oscillation", "BaseObstacle", "GoalAlign", "PathAlign", "PathDist", "GoalDist"]
      BaseObstacle.scale: 0.02
      PathAlign.scale: 32.0
      PathAlign.forward_point_distance: 0.1
      GoalAlign.scale: 24.0
      GoalAlign.forward_point_distance: 0.1
      PathDist.scale: 32.0
      GoalDist.scale: 24.0
      RotateToGoal.scale: 32.0
      RotateToGoal.slowing_factor: 5.0
      RotateToGoal.lookahead_time: -1.0

local_costmap:
  local_costmap:
    ros__parameters:
      update_frequency: 5.0
      publish_frequency: 2.0
      global_frame: odom
      robot_base_frame: base_link
      use_sim_time: True
      rolling_window: true
      width: 3
      height: 3
      resolution: 0.05
      robot_radius: 0.08
      #footprint: "[ [0.089, 0.069], [0.089, -0.069], [-0.089, -0.069], [-0.089, 0.069] ]"
      plugins: ["voxel_layer", "inflation_layer"]
      inflation_layer:
        plugin: "nav2_costmap_2d::InflationLayer"
        cost_scaling_factor: 3.0
        inflation_radius: 0.15 #0.25
      voxel_layer:
        plugin: "nav2_costmap_2d::VoxelLayer"
        enabled: True
        publish_voxel_map: True
        origin_z: 0.0
        z_resolution: 0.05
        z_voxels: 16
        max_obstacle_height: 2.0
        mark_threshold: 0
        observation_sources: scan
        scan:
          topic: /scan
          max_obstacle_height: 2.0
          clearing: True
          marking: True
          data_type: "LaserScan"
          raytrace_max_range: 3.0
          raytrace_min_range: 0.0
          obstacle_max_range: 2.5
          obstacle_min_range: 0.0
      static_layer:
        map_subscribe_transient_local: True
      always_send_full_costmap: True
        

planner_server.yaml

planner_server:
  ros__parameters:
    expected_planner_frequency: 10.0
    use_sim_time: True
    planner_plugins: ["GridBased"]
    GridBased:
      plugin: "nav2_navfn_planner/NavfnPlanner"
      tolerance: 0.5
      use_astar: false
      allow_unknown: true

global_costmap:
  global_costmap:
    ros__parameters:
      update_frequency: 1.0
      publish_frequency: 1.0
      global_frame: map
      robot_base_frame: base_link
      use_sim_time: True
      robot_radius: 0.08
      resolution: 0.05
      track_unknown_space: true
      plugins: ["static_layer", "inflation_layer"]
      static_layer:
        plugin: "nav2_costmap_2d::StaticLayer"
        map_subscribe_transient_local: True
      inflation_layer:
        plugin: "nav2_costmap_2d::InflationLayer"
        cost_scaling_factor: 3.0
        inflation_radius: 0.15 #0.25
      always_send_full_costmap: True

recovery.yaml

recoveries_server:
  ros__parameters:
    costmap_topic: local_costmap/costmap_raw
    footprint_topic: local_costmap/published_footprint
    cycle_frequency: 10.0
    recovery_plugins: ["spin", "backup", "wait"]
    spin:
      plugin: "nav2_recoveries/Spin"
    backup:
      plugin: "nav2_recoveries/BackUp"
    wait:
      plugin: "nav2_recoveries/Wait"
    global_frame: odom
    robot_base_frame: base_link
    transform_timeout: 0.1
    use_sim_time: true
    simulate_ahead_time: 2.0
    max_rotational_vel: 1.0
    min_rotational_vel: 0.4
    rotational_acc_lim: 3.2

Hi,

Can you clarify what you are trying to do? Are you trying to migrate a rosject from Foxy to Galactic?

So it looks like the robot goes straight into a recovery spin and based on this error, I have a couple of ideas you can try. Also you can discard anything related to localization because it is working. That warning you mention happens often.

The error:

[bt_navigator-4] [WARN] [1701102912.126806438] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose

suggest that the call sent to the server is not arriving or being acknowledged.

That could be for many different reasons, but I doubt it is something you wrote, but rather something with the current setup you have in your rosject.

You can do these checks:

  • sudo apt update
  • Check the RMW implementation is the same in both distributions. I recommend CycloneDDS: export RMW_IMPLEMENTATION=rmw_cyclonedds_cpp. If it gives out an error, then install it through apt
  • echo cmd_vel. Are you getting messages? If not, then the issue comes before that.

Hello,

yes that’s it.

Ok perfect.

I followed these steps and installed using sudo apt install ros-galactic-rmw-cyclonedds-cpp

user:~/ros2_ws$ ros2 launch project_path_planning pathplanner.launch.py[INFO] [launch]: All log files can be found below /home/user/.ros/log/2023-11-29-14-31-16-173198-1_xterm-19405
[INFO] [launch]: Default logging verbosity is set to INFO
[INFO] [controller_server-1]: process started with pid [19422]
[INFO] [planner_server-2]: process started with pid [19424]
[INFO] [recoveries_server-3]: process started with pid [19426]
[INFO] [bt_navigator-4]: process started with pid [19428]
[INFO] [lifecycle_manager-5]: process started with pid [19430]
[controller_server-1] [INFO] [1701268277.774343931] [controller_server]:
[controller_server-1]   controller_server lifecycle node launched.
[controller_server-1]   Waiting on external lifecycle transitions to activate
[controller_server-1]   See https://design.ros2.org/articles/node_lifecycle.html for more information.
[planner_server-2] [INFO] [1701268277.719663550] [planner_server]:
[planner_server-2]      planner_server lifecycle node launched.
[planner_server-2]      Waiting on external lifecycle transitions to activate
[planner_server-2]      See https://design.ros2.org/articles/node_lifecycle.html for more information.
[bt_navigator-4] [INFO] [1701268277.815321589] [bt_navigator]:
[bt_navigator-4]        bt_navigator lifecycle node launched.
[bt_navigator-4]        Waiting on external lifecycle transitions to activate
[bt_navigator-4]        See https://design.ros2.org/articles/node_lifecycle.html for more information.
[bt_navigator-4] [INFO] [1701268277.815477040] [bt_navigator]: Creating
[controller_server-1] [INFO] [1701268277.829770512] [controller_server]: Creating controller server
[lifecycle_manager-5] [INFO] [1701268277.884029184] [lifecycle_manager_pathplanner]: Creating
[planner_server-2] [INFO] [1701268277.886781956] [planner_server]: Creating
[recoveries_server-3] [INFO] [1701268277.912549532] [recoveries_server]:
[recoveries_server-3]   recoveries_server lifecycle node launched.
[recoveries_server-3]   Waiting on external lifecycle transitions to activate
[recoveries_server-3]   See https://design.ros2.org/articles/node_lifecycle.html for more information.
[lifecycle_manager-5] [INFO] [1701268277.914349283] [lifecycle_manager_pathplanner]: Creating and initializing lifecycle service clients
[planner_server-2] [INFO] [1701268277.991426123] [global_costmap.global_costmap]:
[planner_server-2]      global_costmap lifecycle node launched.
[planner_server-2]      Waiting on external lifecycle transitions to activate
[planner_server-2]      See https://design.ros2.org/articles/node_lifecycle.html for more information.
[planner_server-2] [INFO] [1701268278.001086086] [global_costmap.global_costmap]: Creating Costmap
[lifecycle_manager-5] [INFO] [1701268278.089601516] [lifecycle_manager_pathplanner]: Starting managed nodes bringup...
[lifecycle_manager-5] [INFO] [1701268278.089684139] [lifecycle_manager_pathplanner]: Configuring planner_server
[controller_server-1] [INFO] [1701268278.126069126] [local_costmap.local_costmap]:
[controller_server-1]   local_costmap lifecycle node launched.
[controller_server-1]   Waiting on external lifecycle transitions to activate
[controller_server-1]   See https://design.ros2.org/articles/node_lifecycle.html for more information.
[controller_server-1] [INFO] [1701268278.128728014] [local_costmap.local_costmap]: Creating Costmap
[planner_server-2] [INFO] [1701268278.320569756] [planner_server]: Configuring
[planner_server-2] [INFO] [1701268278.320629828] [global_costmap.global_costmap]: Configuring
[planner_server-2] [INFO] [1701268278.329788131] [global_costmap.global_costmap]: Using plugin "static_layer"
[planner_server-2] [INFO] [1701268278.336554464] [global_costmap.global_costmap]: Subscribing to the map topic (/map) with transient local durability
[planner_server-2] [INFO] [1701268278.337913545] [global_costmap.global_costmap]: Initialized plugin "static_layer"
[planner_server-2] [INFO] [1701268278.337959914] [global_costmap.global_costmap]: Using plugin "inflation_layer"
[planner_server-2] [INFO] [1701268278.343741765] [global_costmap.global_costmap]: Initialized plugin "inflation_layer"
[planner_server-2] [INFO] [1701268278.353729010] [planner_server]: Created global planner plugin GridBased of type nav2_navfn_planner/NavfnPlanner
[planner_server-2] [INFO] [1701268278.353786410] [planner_server]: Configuring plugin GridBased of type NavfnPlanner
[planner_server-2] [INFO] [1701268278.395412021] [planner_server]: Planner Server has GridBased  planners available.
[planner_server-2] [INFO] [1701268278.413389512] [global_costmap.global_costmap]: StaticLayer: Resizing costmap to 55 X 50 at 0.050000 m/pix
[lifecycle_manager-5] [INFO] [1701268278.420250724] [lifecycle_manager_pathplanner]: Configuring controller_server
[controller_server-1] [INFO] [1701268278.420695176] [controller_server]: Configuring controller interface
[controller_server-1] [INFO] [1701268278.422305856] [controller_server]: getting goal checker plugins..
[controller_server-1] [INFO] [1701268278.422478091] [controller_server]: Controller frequency set to 10.0000Hz
[controller_server-1] [INFO] [1701268278.422513583] [local_costmap.local_costmap]: Configuring
[controller_server-1] [INFO] [1701268278.432634491] [local_costmap.local_costmap]: Using plugin "voxel_layer"
[controller_server-1] [INFO] [1701268278.487850621] [local_costmap.local_costmap]: Subscribed to Topics: scan
[controller_server-1] [INFO] [1701268278.595630980] [local_costmap.local_costmap]: Initialized plugin "voxel_layer"
[controller_server-1] [INFO] [1701268278.595690509] [local_costmap.local_costmap]: Using plugin "inflation_layer"
[controller_server-1] [INFO] [1701268278.599149362] [local_costmap.local_costmap]: Initialized plugin "inflation_layer"
[controller_server-1] [INFO] [1701268278.616933025] [controller_server]: Created progress_checker : progress_checker of type nav2_controller::SimpleProgressChecker
[controller_server-1] [INFO] [1701268278.625284837] [controller_server]: Created goal checker : general_goal_checker of type nav2_controller::SimpleGoalChecker
[controller_server-1] [INFO] [1701268278.673305376] [controller_server]: Controller Server has general_goal_checker  goal checkers available.
[controller_server-1] [INFO] [1701268278.686837600] [controller_server]: Created controller : FollowPath of type dwb_core::DWBLocalPlanner
[controller_server-1] [INFO] [1701268278.692865462] [controller_server]: Setting transform_tolerance to 0.200000
[controller_server-1] [INFO] [1701268278.815628405] [controller_server]: Using critic "RotateToGoal" (dwb_critics::RotateToGoalCritic)
[controller_server-1] [INFO] [1701268278.826255417] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701268278.828512069] [controller_server]: Using critic "Oscillation" (dwb_critics::OscillationCritic)
[controller_server-1] [INFO] [1701268278.831732738] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701268278.832880027] [controller_server]: Using critic "BaseObstacle" (dwb_critics::BaseObstacleCritic)
[controller_server-1] [INFO] [1701268278.833936673] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701268278.834470117] [controller_server]: Using critic "GoalAlign" (dwb_critics::GoalAlignCritic)
[controller_server-1] [INFO] [1701268278.836176956] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701268278.836787206] [controller_server]: Using critic "PathAlign" (dwb_critics::PathAlignCritic)
[controller_server-1] [INFO] [1701268278.838172655] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701268278.838802278] [controller_server]: Using critic "PathDist" (dwb_critics::PathDistCritic)
[controller_server-1] [INFO] [1701268278.840552181] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701268278.840790545] [controller_server]: Using critic "GoalDist" (dwb_critics::GoalDistCritic)
[controller_server-1] [INFO] [1701268278.841649919] [controller_server]: Critic plugin initialized
[controller_server-1] [INFO] [1701268278.841684110] [controller_server]: Controller Server has FollowPath  controllers available.
[lifecycle_manager-5] [INFO] [1701268278.882583676] [lifecycle_manager_pathplanner]: Configuring recoveries_server
[recoveries_server-3] [INFO] [1701268278.882922795] [recoveries_server]: Configuring
[recoveries_server-3] [INFO] [1701268278.895070161] [recoveries_server]: Creating recovery plugin spin of type nav2_recoveries/Spin
[recoveries_server-3] [INFO] [1701268278.904132549] [recoveries_server]: Configuring spin
[recoveries_server-3] [INFO] [1701268278.973072298] [recoveries_server]: Creating recovery plugin backup of type nav2_recoveries/BackUp
[recoveries_server-3] [INFO] [1701268278.975627581] [recoveries_server]: Configuring backup
[recoveries_server-3] [INFO] [1701268278.988989574] [recoveries_server]: Creating recovery plugin wait of type nav2_recoveries/Wait
[recoveries_server-3] [INFO] [1701268278.991331718] [recoveries_server]: Configuring wait
[lifecycle_manager-5] [INFO] [1701268279.093782755] [lifecycle_manager_pathplanner]: Configuring bt_navigator
[bt_navigator-4] [INFO] [1701268279.094488363] [bt_navigator]: Configuring
[lifecycle_manager-5] [INFO] [1701268279.416463999] [lifecycle_manager_pathplanner]: Activating planner_server
[planner_server-2] [INFO] [1701268279.417338158] [planner_server]: Activating
[planner_server-2] [INFO] [1701268279.417387117] [global_costmap.global_costmap]: Activating
[planner_server-2] [INFO] [1701268279.417409237] [global_costmap.global_costmap]: Checking transform
[planner_server-2] [INFO] [1701268279.417513299] [global_costmap.global_costmap]: Timed out waiting for transform from base_link to map to become available, tf error: Lookup would require extrapolation into the past.  Requested time 49.270000 but the earliest data is at time 49.409000, when looking up transform from frame [base_link] to frame [map]
[planner_server-2] [INFO] [1701268280.036263321] [global_costmap.global_costmap]: start
[planner_server-2] [INFO] [1701268280.120358129] [planner_server]: Activating plugin GridBased of type NavfnPlanner
[planner_server-2] [INFO] [1701268280.120438037] [planner_server]: Creating bond (planner_server) to lifecycle manager.
[lifecycle_manager-5] [INFO] [1701268280.295096702] [lifecycle_manager_pathplanner]: Server planner_server connected with bond.
[lifecycle_manager-5] [INFO] [1701268280.295164315] [lifecycle_manager_pathplanner]: Activating controller_server
[controller_server-1] [INFO] [1701268280.302552477] [controller_server]: Activating
[controller_server-1] [INFO] [1701268280.302606664] [local_costmap.local_costmap]: Activating
[controller_server-1] [INFO] [1701268280.302627137] [local_costmap.local_costmap]: Checking transform
[controller_server-1] [INFO] [1701268280.302739701] [local_costmap.local_costmap]: start
[controller_server-1] [INFO] [1701268280.376609343] [controller_server]: Creating bond (controller_server) to lifecycle manager.
[lifecycle_manager-5] [INFO] [1701268280.494101658] [lifecycle_manager_pathplanner]: Server controller_server connected with bond.
[lifecycle_manager-5] [INFO] [1701268280.494174405] [lifecycle_manager_pathplanner]: Activating recoveries_server
[recoveries_server-3] [INFO] [1701268280.494506096] [recoveries_server]: Activating
[recoveries_server-3] [INFO] [1701268280.494548764] [recoveries_server]: Activating spin
[recoveries_server-3] [INFO] [1701268280.494566389] [recoveries_server]: Activating backup
[recoveries_server-3] [INFO] [1701268280.494580297] [recoveries_server]: Activating wait
[recoveries_server-3] [INFO] [1701268280.494594586] [recoveries_server]: Creating bond (recoveries_server) to lifecycle manager.
[lifecycle_manager-5] [INFO] [1701268280.703459587] [lifecycle_manager_pathplanner]: Server recoveries_server connected with bond.
[lifecycle_manager-5] [INFO] [1701268280.703519904] [lifecycle_manager_pathplanner]: Activating bt_navigator
[bt_navigator-4] [INFO] [1701268280.704210900] [bt_navigator]: Activating
[bt_navigator-4] [INFO] [1701268280.806032774] [bt_navigator]: Creating bond (bt_navigator) to lifecycle manager.
[lifecycle_manager-5] [INFO] [1701268281.014265047] [lifecycle_manager_pathplanner]: Server bt_navigator connected with bond.
[lifecycle_manager-5] [INFO] [1701268281.014333630] [lifecycle_manager_pathplanner]: Managed nodes are active
[lifecycle_manager-5] [INFO] [1701268281.014354434] [lifecycle_manager_pathplanner]: Creating bond timer...
[bt_navigator-4] [INFO] [1701268294.598365669] [bt_navigator]: Begin navigating from current location to (0.70, -0.01)
[bt_navigator-4] [WARN] [1701268294.629878786] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701268294.630940527] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[bt_navigator-4] [WARN] [1701268294.670333718] [bt_navigatornavigate_to_pose_rclcpp_node]: Node timed out while executing service call to global_costmap/clear_entirely_global_costmap.
[controller_server-1] [INFO] [1701268294.672063122] [local_costmap.local_costmap]: Received request to clear entirely the local_costmap
[planner_server-2] [INFO] [1701268294.683524342] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[bt_navigator-4] [WARN] [1701268294.723529470] [bt_navigatornavigate_to_pose_rclcpp_node]: Node timed out while executing service call to global_costmap/clear_entirely_global_costmap.
[bt_navigator-4] [ERROR] [1701268294.723781000] [bt_navigator]: Goal failed
[bt_navigator-4] [WARN] [1701268294.723816819] [bt_navigator]: [navigate_to_pose] [ActionServer] Aborting handle.
[controller_server-1] [INFO] [1701268295.048001290] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 57.501 for reason 'the timestamp on the message is earlierthan all the data in the transform cache'
[controller_server-1] [INFO] [1701268297.699937967] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 58.712 for reason 'the timestamp on the message is earlierthan all the data in the transform cache'

And it just doesn’t move.

Sometimes this ans still doesn’t move

[bt_navigator-4] [INFO] [1701268507.286251409] [bt_navigator]: Begin navigating from current location to (0.75, -0.11)
[bt_navigator-4] [WARN] [1701268507.333105122] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701268507.334197311] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[bt_navigator-4] [WARN] [1701268507.444835834] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701268507.445044561] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[bt_navigator-4] [WARN] [1701268507.493200735] [bt_navigatornavigate_to_pose_rclcpp_node]: Node timed out while executing service call to global_costmap/clear_entirely_global_costmap.
[bt_navigator-4] [ERROR] [1701268507.493509023] [bt_navigator]: Goal failed
[bt_navigator-4] [WARN] [1701268507.493547225] [bt_navigator]: [navigate_to_pose] [ActionServer] Aborting handle.
[planner_server-2] [WARN] [1701268508.067776799] [planner_server]: Planner loop missed its desired rate of 10.0000 Hz. Current loop rate is 1.5047 Hz

On another try it did this moving:

[lifecycle_manager-5] [INFO] [1701268863.899979328] [lifecycle_manager_pathplanner]: Creating bond timer...
[bt_navigator-4] [INFO] [1701268868.803245106] [bt_navigator]: Begin navigating from current location to (0.69, -0.15)
[controller_server-1] [INFO] [1701268868.844045446] [controller_server]: Received a goal, begin computing control effort.
[controller_server-1] [WARN] [1701268868.848141885] [controller_server]: No goal checker was specified in parameter 'current_goal_checker'. Server will use only plugin loaded general_goal_checker . This warning will appear once.
[bt_navigator-4] [WARN] [1701268868.965317027] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for follow_path
[controller_server-1] [INFO] [1701268868.965540174] [local_costmap.local_costmap]: Received request to clear entirely the local_costmap
[controller_server-1] [INFO] [1701268869.011016932] [controller_server]: Passing new path to controller.
[bt_navigator-4] [WARN] [1701268869.105868478] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for follow_path
[controller_server-1] [INFO] [1701268869.108639719] [local_costmap.local_costmap]: Received request to clear entirely the local_costmap
[planner_server-2] [INFO] [1701268869.140406355] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[recoveries_server-3] [INFO] [1701268869.351719574] [recoveries_server]: Attempting spin
[recoveries_server-3] [INFO] [1701268869.351926487] [recoveries_server]: Turning 1.57 for spin recovery.
[controller_server-1] [WARN] [1701268869.351791914] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[bt_navigator-4] [WARN] [1701268869.391980379] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for spin
[bt_navigator-4] [ERROR] [1701268869.437058667] [bt_navigator]: Goal failed
[bt_navigator-4] [WARN] [1701268869.437139767] [bt_navigator]: [navigate_to_pose] [ActionServer] Aborting handle.
[controller_server-1] [WARN] [1701268871.405738503] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268872.610127770] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268872.761360693] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268880.272464357] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268883.506866537] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268884.523837561] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268884.852927218] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268886.683495720] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268887.686109774] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268888.472583840] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268889.093602768] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268889.832623115] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268890.206585706] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268890.503991289] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268892.265111241] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268892.604124217] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268893.410887885] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268894.501918014] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268895.788629098] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268895.872675440] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268896.202040079] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268896.498540694] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [WARN] [1701268896.764796932] [controller_server]: Control loop missed its desired rate of 10.0000Hz
[controller_server-1] [ERROR] [1701268897.024464678] [controller_server]: Failed to make progress
[controller_server-1] [WARN] [1701268897.025922418] [controller_server_rclcpp_node]: [follow_path] [ActionServer] Aborting handle.
[recoveries_server-3] [INFO] [1701268901.264620572] [recoveries_server]: spin completed successfully
[controller_server-1] [INFO] [

with this strange behavior

I don’t understand why the behavior is not the same: sometimes juste not moving, sometimes moving but with strange trajectory, sometimes working following the path 2 times and then blocking, or spin at each request (like in the previous message and shown bellow).

before request

After request

[bt_navigator-4] [INFO] [1701270615.314545585] [bt_navigator]: Begin navigating from current location to (0.83, -0.54)
[bt_navigator-4] [WARN] [1701270615.399330158] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701270615.400837812] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[bt_navigator-4] [WARN] [1701270615.525837399] [bt_navigatornavigate_to_pose_rclcpp_node]: Node timed out while executing service call to global_costmap/clear_entirely_global_costmap.
[bt_navigator-4] [WARN] [1701270615.568754581] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for spin
[recoveries_server-3] [INFO] [1701270615.569978104] [recoveries_server]: Attempting spin
[recoveries_server-3] [INFO] [1701270615.570068643] [recoveries_server]: Turning 1.57 for spin recovery.
[bt_navigator-4] [ERROR] [1701270615.611716793] [bt_navigator]: Goal failed
[bt_navigator-4] [WARN] [1701270615.611789929] [bt_navigator]: [navigate_to_pose] [ActionServer] Aborting handle.
[recoveries_server-3] [INFO] [1701270619.313085059] [recoveries_server]: spin completed successfully

Maybe the problem comes from the bt navigator because it always dies in an error after CTRL-C even just after the launch without other action

[WARNING] [launch]: user interrupted with ctrl-c (SIGINT)
[recoveries_server-3] [INFO] [1701271120.363021526] [rclcpp]: signal_handler(signal_value=2)
[bt_navigator-4] [INFO] [1701271120.363022433] [rclcpp]: signal_handler(signal_value=2)
[lifecycle_manager-5] [INFO] [1701271120.363019666] [rclcpp]: signal_handler(signal_value=2)
[controller_server-1] [INFO] [1701271120.364068080] [rclcpp]: signal_handler(signal_value=2)
[planner_server-2] [INFO] [1701271120.367015073] [rclcpp]: signal_handler(signal_value=2)
[INFO] [lifecycle_manager-5]: process has finished cleanly [pid 32156]
[planner_server-2] [INFO] [1701271120.404909756] [planner_server]: Destroying plugin GridBased of type NavfnPlanner
[planner_server-2] Warning: class_loader.ClassLoader: SEVERE WARNING!!! Attempting to unload library while objects created by this loader exist in the heap! You should delete your objects before attempting to unload the library or destroying the ClassLoader. The library will NOT be unloaded.
[planner_server-2]          at line 127 in /tmp/binarydeb/ros-galactic-class-loader-2.1.2/src/class_loader.cpp
[recoveries_server-3] [INFO] [1701271120.696320885] [recoveries_server]: Destroying
[planner_server-2] [INFO] [1701271120.713797400] [global_costmap.global_costmap]: Destroying
[controller_server-1] Warning: class_loader.ClassLoader: SEVERE WARNING!!! Attempting to unload library while objects created by this loader exist in the heap! You should delete your objects before attempting to unload the library or destroying the ClassLoader. The library will NOT be unloaded.
[controller_server-1]          at line 127 in /tmp/binarydeb/ros-galactic-class-loader-2.1.2/src/class_loader.cpp
[controller_server-1] [INFO] [1701271121.246703743] [local_costmap.local_costmap]: Destroying
[planner_server-2] [INFO] [1701271121.332122432] [planner_server]: Destroying
[bt_navigator-4] [INFO] [1701271121.667346444] [bt_navigator]: Destroying
[controller_server-1] [INFO] [1701271121.894043679] [controller_server]: Destroying
[INFO] [recoveries_server-3]: process has finished cleanly [pid 32152]
[INFO] [planner_server-2]: process has finished cleanly [pid 32150]
[INFO] [controller_server-1]: process has finished cleanly [pid 32148]
[ERROR] [bt_navigator-4]: process[bt_navigator-4] failed to terminate '5' seconds after receiving 'SIGINT', escalating to 'SIGTERM'
[INFO] [bt_navigator-4]: sending signal 'SIGTERM' to process[bt_navigator-4]
[ERROR] [bt_navigator-4]: process has died [pid 32154, exit code -15, cmd '/opt/ros/galactic/lib/nav2_bt_navigator/bt_navigator --ros-args -r__node:=bt_navigator --params-file /home/user/ros2_ws/install/project_path_planning/share/project_path_planning/config/bt_navigator.yaml'].

What do you mean when you say the bt_navigator always dies in an error after Ctrl-C? It’s supposed to die if you do that.

I’m still not clear on what RMW_IMPLEMENTATION you are using. I say this because I know Foxy fastdds comes with a different default one than Galactic cyclonedds.

The weird behaviors are probably the three recovery behaviors doing its job. You can remove the launch of the recovery server to keep debugging.

If the control frequency is giving out those warnings, then decrease it.

If the robot sometimes tries to go to the goal like in the second screenshot, then that means it worked, but something about your setup is preventing it from reaching the goal. Things you can test:

  • What is the robot footprint? I don’t see it in your screenshots and it may be too big
  • Decrease your inflation radius

Migrating a package from distribution to distribution can be challenging, especially since the apt packages installed will be different.

What you can also do is start from scratch, in a Galactic rosject with the same simulation. You can fork and change distributions of rosjects. Of course, you also might run into other issues.

bt_navigator doesn’t die cleanly

I decreased it but it continued to say the same

I already changes all of this and put it at the size of the robot. it worked better but not enough

I’m going to restart from scratch, I and I will try to do everything directly in galactic

Before restarting all I came back to foxy and took back my old files.
It worked a few times without problem and now it moves when it wants.

it is frustrating because it works pretty well.

but as said in this post it seems it is proper to the foxy version

In galactic, I copied and pasted all the galactic navigation codes.
For the moment, I’m at the chapter 4 how to do path planning: it works really well without the global an local cost maps options added to planner and controler.

it is strange because if I display the local and global cost maps in RVIZ it doesn’t have sense

it is interesting to see that there is no info message about the timestamp

[bt_navigator-4] [INFO] [1701356956.017590485] [bt_navigator]: Begin navigating from current location to (0.87, -0.04)
[controller_server-1] [INFO] [1701356956.045069016] [controller_server]: Received a goal, begin computing control effort.
[controller_server-1] [WARN] [1701356956.045861904] [controller_server]: Nogoal checker was specified in parameter 'current_goal_checker'. Server willuse only plugin loaded general_goal_checker . This warning will appear once.
[controller_server-1] [INFO] [1701356957.251907211] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356958.249039409] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356959.250172619] [controller_server]: Passing new path to controller.
[bt_navigator-4] [WARN] [1701356960.166849159] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701356960.167047683] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[bt_navigator-4] [WARN] [1701356960.194179147] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[controller_server-1] [INFO] [1701356960.205480861] [local_costmap.local_costmap]: Received request to clear entirely the local_costmap
[bt_navigator-4] [WARN] [1701356960.237257638] [bt_navigatornavigate_to_pose_rclcpp_node]: Node timed out while executing service call to global_costmap/clear_entirely_global_costmap.
[bt_navigator-4] [ERROR] [1701356960.237552732] [bt_navigator]: Goal failed
[bt_navigator-4] [WARN] [1701356960.237584454] [bt_navigator]: [navigate_to_pose] [ActionServer] Aborting handle.
[planner_server-2] [INFO] [1701356960.239805079] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[controller_server-1] [INFO] [1701356960.251607779] [controller_server]: Goal was canceled. Stopping the robot.
[controller_server-1] [WARN] [1701356960.251678788] [controller_server_rclcpp_node]: [follow_path] [ActionServer] Client requested to cancel the goal. Cancelling.
[planner_server-2] [WARN] [1701356960.424594054] [planner_server]: Planner loop missed its desired rate of 5.0000 Hz. Current loop rate is 3.9822 Hz
[bt_navigator-4] [INFO] [1701356978.429023523] [bt_navigator]: Begin navigating from current location to (0.90, -0.93)
[controller_server-1] [INFO] [1701356978.480826626] [controller_server]: Received a goal, begin computing control effort.
[controller_server-1] [INFO] [1701356979.494927802] [controller_server]: Passing new path to controller.
[bt_navigator-4] [WARN] [1701356980.569300503] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for follow_path
[controller_server-1] [INFO] [1701356980.569528498] [local_costmap.local_costmap]: Received request to clear entirely the local_costmap
[controller_server-1] [WARN] [1701356980.580946720] [controller_server_rclcpp_node]: [follow_path] [ActionServer] Aborting handle.
[controller_server-1] [INFO] [1701356980.686053621] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356981.685585419] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356982.687802947] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356983.685675550] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356984.492356296] [controller_server]: Reached the goal!
[bt_navigator-4] [INFO] [1701356984.530054198] [bt_navigator]: Goal succeeded
[bt_navigator-4] [INFO] [1701356988.895388451] [bt_navigator]: Begin navigating from current location to (-0.18, -1.19)
[controller_server-1] [INFO] [1701356988.967625162] [controller_server]: Received a goal, begin computing control effort.
[controller_server-1] [INFO] [1701356989.977661743] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356991.172170392] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356992.178138453] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356993.170612777] [controller_server]: Passing new path to controller.
[bt_navigator-4] [WARN] [1701356994.145765375] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for follow_path
[controller_server-1] [INFO] [1701356994.147048019] [local_costmap.local_costmap]: Received request to clear entirely the local_costmap
[controller_server-1] [WARN] [1701356994.151883574] [controller_server_rclcpp_node]: [follow_path] [ActionServer] Aborting handle.
[controller_server-1] [INFO] [1701356994.260925956] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356995.169751200] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356996.386068167] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701356996.994246462] [controller_server]: Reached the goal!
[bt_navigator-4] [INFO] [1701356997.042901416] [bt_navigator]: Goal succeeded
[bt_navigator-4] [INFO] [1701357003.252252618] [bt_navigator]: Begin navigating from current location to (-0.63, -0.28)
[controller_server-1] [INFO] [1701357003.286070266] [controller_server]: Received a goal, begin computing control effort.
[controller_server-1] [INFO] [1701357004.487620722] [controller_server]: Passing new path to controller.
[controller_server-1] [INFO] [1701357005.487862602] [controller_server]: Passing new path to controller.
[bt_navigator-4] [WARN] [1701357006.375805252] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701357006.376899489] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[controller_server-1] [INFO] [1701357006.492580546] [controller_server]: Passing new path to controller.
[bt_navigator-4] [WARN] [1701357007.497426518] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701357007.498400682] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[controller_server-1] [INFO] [1701357007.695021785] [controller_server]: Passing new path to controller.
[bt_navigator-4] [WARN] [1701357008.740501741] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for follow_path
[controller_server-1] [INFO] [1701357008.742719138] [local_costmap.local_costmap]: Received request to clear entirely the local_costmap
[controller_server-1] [WARN] [1701357008.747355631] [controller_server_rclcpp_node]: [follow_path] [ActionServer] Aborting handle.
[controller_server-1] [INFO] [1701357008.894587841] [controller_server]: Passing new path to controller.
[bt_navigator-4] [WARN] [1701357009.742333037] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701357009.743025766] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[bt_navigator-4] [WARN] [1701357009.780016869] [bt_navigatornavigate_to_pose_rclcpp_node]: Timed out while waiting for action server to acknowledge goal request for compute_path_to_pose
[planner_server-2] [INFO] [1701357009.787488334] [global_costmap.global_costmap]: Received request to clear entirely the global_costmap
[recoveries_server-3] [INFO] [1701357009.793784725] [recoveries_server]: Attempting spin
[recoveries_server-3] [INFO] [1701357009.795060583] [recoveries_server]: Turning 1.57 for spin recovery.
[controller_server-1] [INFO] [1701357009.890464836] [controller_server]: Goal was canceled. Stopping the robot.
[controller_server-1] [WARN] [1701357009.890538708] [controller_server_rclcpp_node]: [follow_path] [ActionServer] Client requested to cancel the goal. Cancelling.
[recoveries_server-3] [WARN] [1701357011.408483596] [recoveries_server]: Collision Ahead - Exiting Spin
[recoveries_server-3] [WARN] [1701357011.408547931] [recoveries_server]: spin failed
[recoveries_server-3] [WARN] [1701357011.408586572] [recoveries_server]: [spin] [ActionServer] Aborting handle.
[bt_navigator-4] [ERROR] [1701357011.441707572] [bt_navigator]: Goal failed
[bt_navigator-4] [WARN] [1701357011.441784575] [bt_navigator]: [navigate_to_pose] [ActionServer] Aborting handle.

The time stamp info when the local and the global costmaps are added that appears sometimes but less than my previous galactic setup

[planner_server-2] [INFO] [1701359597.329230364] [global_costmap.global_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 2949.084 for reason 'the timestamp on the message is earlier than all the data in the transform cache'
[controller_server-1] [INFO] [1701359597.331076393] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 2949.084 for reason 'the timestamp on the message is earlier than all thedata in the transform cache'
[controller_server-1] [INFO] [1701359657.647106685] [local_costmap.local_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 2983.775 for reason 'the timestamp on the message is earlier than all thedata in the transform cache'
[planner_server-2] [INFO] [1701359720.673335296] [global_costmap.global_costmap_rclcpp_node]: Message Filter dropping message: frame 'base_scan' at time 3018.951 for reason 'the timestamp on the message is earlier than all the data in the transform cache'

But I don’t know why it works really better except some strange behaviors

1 Like

I still have the bt-navigator not ending cleanly. It doesnt seem to be a problem but I don’t know if it’s normal. I suppose that it’s not.

[WARNING] [launch]: user interrupted with ctrl-c (SIGINT)
[bt_navigator-4] [INFO] [1701426506.962958066] [rclcpp]: signal_handler(signal_value=2)
[INFO] [lifecycle_manager-5]: process has finished cleanly [pid 11919]
[recoveries_server-3] [INFO] [1701426506.962970307] [rclcpp]: signal_handler(signal_value=2)
[planner_server-2] [INFO] [1701426506.962983091] [rclcpp]: signal_handler(signal_value=2)
[lifecycle_manager-5] [INFO] [1701426506.963002428] [rclcpp]: signal_handler(signal_value=2)
[controller_server-1] [INFO] [1701426506.968195674] [rclcpp]: signal_handler(signal_value=2)
[planner_server-2] [INFO] [1701426506.976814952] [planner_server]: Destroying plugin GridBased of type NavfnPlanner
[planner_server-2] Warning: class_loader.ClassLoader: SEVERE WARNING!!! Attempting to unload library while objects created by this loader exist in the heap! You should delete your objects before attempting to unload the libraryor destroying the ClassLoader. The library will NOT be unloaded.
[planner_server-2]          at line 127 in /tmp/binarydeb/ros-galactic-class-loader-2.1.2/src/class_loader.cpp
[controller_server-1] Warning: class_loader.ClassLoader: SEVERE WARNING!!! Attempting to unload library while objects created by this loader exist in the heap! You should delete your objects before attempting to unload the library or destroying the ClassLoader. The library will NOT be unloaded.
[controller_server-1]          at line 127 in /tmp/binarydeb/ros-galactic-class-loader-2.1.2/src/class_loader.cpp
[recoveries_server-3] [INFO] [1701426507.190450993] [recoveries_server]: Destroying
[planner_server-2] [INFO] [1701426507.277176573] [global_costmap.global_costmap]: Destroying
[controller_server-1] [INFO] [1701426507.378333996] [local_costmap.local_costmap]: Destroying
[controller_server-1] [INFO] [1701426507.590314028] [controller_server]: Destroying
[planner_server-2] [INFO] [1701426507.695349642] [planner_server]: Destroying
[bt_navigator-4] [INFO] [1701426507.865659982] [bt_navigator]: Destroying
[INFO] [recoveries_server-3]: process has finished cleanly [pid 11908]
[INFO] [controller_server-1]: process has finished cleanly [pid 11903]
[INFO] [planner_server-2]: process has finished cleanly [pid 11905]
[bt_navigator-4] [PublisherZMQ] Server quitting.
[bt_navigator-4] [PublisherZMQ] just died. Exeption Context was terminated
[ERROR] [bt_navigator-4]: process has died [pid 11913, exit code -11, cmd '/opt/ros/galactic/lib/nav2_bt_navigator/bt_navigator --ros-args -r __node:=bt_navigator --params-file /home/user/ros2_ws/install/project_path_planning/share/project_path_planning/config/bt_navigator.yaml'].

@roalgoal
My galactic version seems to work fine now but I can’t use it with the real robot to prepare the presentation.

image

I’m a little stuck to finally end this courses that I started a while ago

You have to make the project in a Foxy rosject. Check the rosject link described in the course. Check some presentations on it: https://youtube.com/live/kkiao_nu_os?feature=share

You cannot connect to the real robot on a Galactic rosject.

it’s not a problem, no.

I made it first in Foxy but as I said before I migrated to galactic because of the foxy instability with nav2.

The one mentionned here

I made again the packages adapted in foxy and I still have the Action server failed while executing action callback: "send_goal failed" error but at least robot moves 1 time sometimes and I have the 2 costmaps

I tried to use it with the real robot project to see if the problem also persist outside of using gazebo and the path planning still doesn’t work but I also have the costmaps that don’t show in rviz with the same set up than using the sim.

rviz foxy gazebo

rviz foxy real robot

I don’t have any real robot time left for this week

I can’t find why there is such a difference between real and sim. And if the cause of my path planning problems come from the code that works as expected some time and then stops working. Some times it just doesn’t work at all without changing anything

Now I understand the whole thread… Sorry it took me so long.

I also checked the Foxy issue and indeed, there seems to be a stability regression.

Unfortunately right now, only Foxy rosjects can connect to the real robot.

We will be working on this update so it can be done with the latest distribution.

In the meantime, you can go ahead and setup the presentation with the simulation.

Sorry about this issue, and thank you for pointing it out.

1 Like

Thank you I was starting to despair, I wasn’t clear enough with the explaination.

This topic was automatically closed 5 days after the last reply. New replies are no longer allowed.

Hi @pabled91, as a followup, you should now be able to connect to the TurtleBot3 lab, through a Galactic rosject, so the work you did in your migration should work there now