Git Product home page Git Product logo

navigation_tutorials's People

Contributors

dlu avatar k-okada avatar mikeferguson avatar wjwwood avatar

Stargazers

 avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar

Watchers

 avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar

navigation_tutorials's Issues

tf issues

Hi,I have problem on running the roslaunch navigation_stage move_base_multi_robot.launch.
ros kinetic
the issuse is like this:
[ WARN] [1588174911.499353540, 5.100000000]: Timed out waiting for transform from robot_0/base_link to robot_0/map to become available before running costmap, tf error: canTransform: target_frame robot_0/map does not exist.. canTransform returned after 0.1 timeout was 0.1.
[ WARN] [1588174911.500381703, 5.100000000]: Timed out waiting for transform from robot_1/base_link to robot_1/map to become available before running costmap, tf error: canTransform: target_frame robot_1/map does not exist.. canTransform returned after 0.1 timeout was 0.1.

Merge Map

Hello, I want to know whether it can merge multi-robot's maps? Or just try to control different robots?

Wrong pose in .world files

Due to fixes on stage (stage_ros) coordinate systems, poses of map and robots in .world files are wrong, and is not possible to set a goal because laser frames appears out of map. I have been working with multi-robot example and these are the lines that I fixed in willow-pr2-multi.world file (uncommented lines are the corrected positions):

#pose [ -26.300 29.200 0 90.000 ]
pose [ 29.200 26.300 0 0 ]

...

#pr2( pose [ -21.670 47.120 0 28.166 ] name "pr2_0" color "blue")
#pr2( pose [ -21.670 48.120 0 28.166 ] name "pr2_1" color "green")
#block( pose [ -24.269 48.001 0 180.000 ] color "red")

pr2( pose [ 47.120 21.670 0 28.166 ] name "pr2_0" color "blue")
pr2( pose [ 48.120 21.670 0 28.166 ] name "pr2_1" color "green")
block( pose [ 48.001 24.269 0 180.000 ] color "red")

I suposse that all .world files need to be fixed.

Thanks.

[ERROR] Costmap filters launch: InvalidFrontendLaunchFileError

O.S : Linux Ubuntu 22.04 LTS (x86)
ROS2 - Humble Hawksbill

Followed the Keep Out filter tutorial from
https://docs.nav2.org/tutorials/docs/navigation2_with_keepout_filter.html
and saw this error while launching

$ ros2 launch nav2_costmap_filters_demo costmap_filter_info.launch.py params_file:=`pwd`/src/navigation2_tutorials/nav2_costmap_filters_demo/params/keepout_params.yaml mask:=`pwd`/src/navigation2_tutorials/nav2_costmap_filters_demo/maps/keepout_mask.yaml use_composition:=True

[ERROR] [launch]: Caught exception in launch (see debug for traceback): Caught multiple exceptions when trying to load file of format [py]:
 - ImportError: cannot import name 'NotEqualsSubstitution' from 'launch.substitutions' (/opt/ros/humble/lib/python3.10/site-packages/launch/substitutions/__init__.py)
 - InvalidFrontendLaunchFileError: The launch file may have a syntax error, or its format is unknown

Made it work doing this changes to python launcher:

import os

from ament_index_python.packages import get_package_share_directory

from launch import LaunchDescription
from launch.actions import DeclareLaunchArgument
from launch.substitutions import LaunchConfiguration
from launch_ros.actions import Node
from nav2_common.launch import RewrittenYaml


def generate_launch_description():
    # Get the launch directory
    costmap_filters_demo_dir = get_package_share_directory('mss_keepout_filter')

    # Create our own temporary YAML files that include substitutions
    lifecycle_nodes = ['filter_mask_server', 'costmap_filter_info_server']

    # Parameters
    namespace = LaunchConfiguration('namespace')
    use_sim_time = LaunchConfiguration('use_sim_time')
    autostart = LaunchConfiguration('autostart')
    params_file = LaunchConfiguration('params_file')
    mask_yaml_file = LaunchConfiguration('mask')

    # Declare the launch arguments
    declare_namespace_cmd = DeclareLaunchArgument(
        'namespace',
        default_value='',
        description='Top-level namespace')

    declare_use_sim_time_cmd = DeclareLaunchArgument(
        'use_sim_time',
        default_value='true',
        description='Use simulation (Gazebo) clock if true')

    declare_autostart_cmd = DeclareLaunchArgument(
        'autostart', default_value='true',
        description='Automatically startup the nav2 stack')

    declare_params_file_cmd = DeclareLaunchArgument(
            'params_file',
            default_value=os.path.join(costmap_filters_demo_dir, 'params', 'keepout_params.yaml'),
            description='Full path to the ROS 2 parameters file to use')

    declare_mask_yaml_file_cmd = DeclareLaunchArgument(
            'mask',
            default_value=('/root/MecaluxFileSystem/Maps/Current/GeneralCostmap/ActiveKeepoutMap.yaml'),
            description='Full path to filter mask yaml file to load')

    # Make re-written yaml
    param_substitutions = {
        'use_sim_time': use_sim_time,
        'yaml_filename': mask_yaml_file}

    configured_params = RewrittenYaml(
        source_file=params_file,
        root_key=namespace,
        param_rewrites=param_substitutions,
        convert_types=True)

    # Nodes launching commands
    start_lifecycle_manager_cmd = Node(
            package='nav2_lifecycle_manager',
            executable='lifecycle_manager',
            name='lifecycle_manager_costmap_filters',
            namespace=namespace,
            output='screen',
            emulate_tty=True,  # https://github.com/ros2/launch/issues/188
            parameters=[{'use_sim_time': use_sim_time},
                        {'autostart': autostart},
                        {'node_names': lifecycle_nodes}])

    start_map_server_cmd = Node(
            package='nav2_map_server',
            executable='map_server',
            name='filter_mask_server',
            namespace=namespace,
            output='screen',
            emulate_tty=True,  # https://github.com/ros2/launch/issues/188
            parameters=[configured_params])

    start_costmap_filter_info_server_cmd = Node(
            package='nav2_map_server',
            executable='costmap_filter_info_server',
            name='costmap_filter_info_server',
            namespace=namespace,
            output='screen',
            emulate_tty=True,  # https://github.com/ros2/launch/issues/188
            parameters=[configured_params])

    ld = LaunchDescription()

    ld.add_action(declare_namespace_cmd)
    ld.add_action(declare_use_sim_time_cmd)
    ld.add_action(declare_autostart_cmd)
    ld.add_action(declare_params_file_cmd)
    ld.add_action(declare_mask_yaml_file_cmd)

    ld.add_action(start_lifecycle_manager_cmd)
    ld.add_action(start_map_server_cmd)
    ld.add_action(start_costmap_filter_info_server_cmd)

    return ld

stack needs new release

last release was Jan 2012. My commits since then (just fixing world files) have not surfaced. So the launch files in navigation_stage are broken with the last release, but fixed on groovy-devel.

@hershwg: maybe this is for you?

rviz dosen't open

When i launch the move_base_multi_robot launch fife, i receive this error
"The origin for the sensor at (9.74, 15.63, 0.15) is out of map bounds. So, the costmap cannot raytrace for it."

Map doesn't synchronize on RVIZ

When i try to run the launch file: move_base_fake_localization_2.5cm.launch, there are 2 issues:

  1. The map is not synchronized such as follow:
    screenshot from 2017-07-13 15-44-33
    I searched online that we should edit the origin of the map but I couldn't find out where to do so. Couldn't find a map.yaml file in the navigation repo too.

  2. The stage window doesn't show up when I launch the file.

p/s: I'm using ROS kinetic and cloned the tutorial from indigo-devel.

Thanks.

Question

Hello,

I am wondering, what does the following line mean in the simple navigation goals code?

goal.target_pose.pose.orientation = tf::createQuaternionMsgFromYaw(M_PI);

thank you,
Aaron

let robot auto explores its surrounding and mapping without manually giving a goal

Dear navigation_tutorials friends,

As far as we know, the navigation stack requires a given goal in order to start a navigation. We were wondering if the stack allows robot automatically explore its surrounding and mapping. (such as greedy frontier exploration).

Since we are new on ros-planning/navigation pkgs, hope to hear your expertise on the issue.

Thanks,
-- Luke

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    ๐Ÿ–– Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. ๐Ÿ“Š๐Ÿ“ˆ๐ŸŽ‰

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google โค๏ธ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.