ROS Turtlebot3 cant launch Navigation
Hey, I just tried to navigate through the standard World by a map I got from SLAM. Here, I get the error, that I cannot launch a node of type: amcl. I got both maps, map.pgm and map.yaml, in the maps folder of turtlebot3_navigation folder. When i do $ roslaunch turtlebot3_navigation turtlebot3_navigation.launch map_file:=$HOME/map.yaml rviz is loads and displays the map, but without the robot. Parallel, i loaded the world in Gazebo, what is necessary by the instructions. The world loads without any problems.
Would be great, if you have hints how to solve that problem. Down, I also inserted the launch file for the navigation.
roslaunch turtlebot3_navigation turtlebot3_navigation.launch map_file:=$HOME/map.yaml
... logging to /home/marcel/.ros/log/d8e2b730-89fb-11e9-8b38-6003088fd8da/roslaunch-marcel-macbookpro-8057.log
Checking log directory for disk usage. This may take awhile.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.
started roslaunch server http://172.11.111.70:400257
SUMMARY
========
PARAMETERS
* /amcl/base_frame_id: base_footprint
* /amcl/gui_publish_rate: 50.0
* /amcl/initial_pose_a: 0.0
* /amcl/initial_pose_x: 0.0
* /amcl/initial_pose_y: 0.0
* /amcl/kld_err: 0.02
* /amcl/laser_lambda_short: 0.1
* /amcl/laser_likelihood_max_dist: 2.0
* /amcl/laser_max_beams: 180
* /amcl/laser_max_range: 3.5
* /amcl/laser_model_type: likelihood_field
* /amcl/laser_sigma_hit: 0.2
* /amcl/laser_z_hit: 0.5
* /amcl/laser_z_max: 0.05
* /amcl/laser_z_rand: 0.5
* /amcl/laser_z_short: 0.05
* /amcl/max_particles: 3000
* /amcl/min_particles: 500
* /amcl/odom_alpha1: 0.1
* /amcl/odom_alpha2: 0.1
* /amcl/odom_alpha3: 0.1
* /amcl/odom_alpha4: 0.1
* /amcl/odom_frame_id: odom
* /amcl/odom_model_type: diff
* /amcl/recovery_alpha_fast: 0.0
* /amcl/recovery_alpha_slow: 0.0
* /amcl/resample_interval: 1
* /amcl/transform_tolerance: 0.5
* /amcl/update_min_a: 0.2
* /amcl/update_min_d: 0.2
* /move_base/DWAPlannerROS/acc_lim_theta: 3.2
* /move_base/DWAPlannerROS/acc_lim_x: 2.5
* /move_base/DWAPlannerROS/acc_lim_y: 0.0
* /move_base/DWAPlannerROS/controller_frequency: 10.0
* /move_base/DWAPlannerROS/forward_point_distance: 0.325
* /move_base/DWAPlannerROS/goal_distance_bias: 20.0
* /move_base/DWAPlannerROS/latch_xy_goal_tolerance: False
* /move_base/DWAPlannerROS/max_rot_vel: 2.75
* /move_base/DWAPlannerROS/max_scaling_factor: 0.2
* /move_base/DWAPlannerROS/max_trans_vel: 0.22
* /move_base/DWAPlannerROS/max_vel_x: 0.22
* /move_base/DWAPlannerROS/max_vel_y: 0.0
* /move_base/DWAPlannerROS/min_rot_vel: 1.37
* /move_base/DWAPlannerROS/min_trans_vel: 0.11
* /move_base/DWAPlannerROS/min_vel_x: -0.22
* /move_base/DWAPlannerROS/min_vel_y: 0.0
* /move_base/DWAPlannerROS/occdist_scale: 0.02
* /move_base/DWAPlannerROS/oscillation_reset_dist: 0.05
* /move_base/DWAPlannerROS/path_distance_bias: 32.0
* /move_base/DWAPlannerROS/publish_cost_grid_pc: True
* /move_base/DWAPlannerROS/publish_traj_pc: True
* /move_base/DWAPlannerROS/scaling_speed: 0.25
* /move_base/DWAPlannerROS/sim_time: 1.5
* /move_base/DWAPlannerROS/stop_time_buffer: 0.2
* /move_base/DWAPlannerROS/vth_samples: 40
* /move_base/DWAPlannerROS/vx_samples: 20
* /move_base/DWAPlannerROS/vy_samples: 0
* /move_base/DWAPlannerROS/xy_goal_tolerance: 0.05
* /move_base/DWAPlannerROS/yaw_goal_tolerance: 0.17
* /move_base/base_local_planner: dwa_local_planner...
* /move_base/conservative_reset_dist: 3.0
* /move_base/controller_frequency: 10.0
* /move_base/controller_patience: 15.0
* /move_base/global_costmap/cost_scaling_factor: 3.0
* /move_base/global_costmap/footprint: [[-0.105, -0.105]...
* /move_base/global_costmap/global_frame: map
* /move_base/global_costmap/inflation_radius: 1.0
* /move_base/global_costmap/map_type: costmap
* /move_base/global_costmap/observation_sources: scan
* /move_base/global_costmap/obstacle_range: 3.0
* /move_base/global_costmap/publish_frequency: 10.0
* /move_base/global_costmap/raytrace_range: 3.5
* /move_base/global_costmap/robot_base_frame: base_footprint
* /move_base/global_costmap/scan/clearing: True
* /move_base/global_costmap/scan/data_type: LaserScan
* /move_base/global_costmap/scan/marking: True
* /move_base/global_costmap/scan/sensor_frame: base_scan
* /move_base/global_costmap/scan/topic: scan ...