slam_karto icon indicating copy to clipboard operation
slam_karto copied to clipboard

Not receiving map in real time

Open saqihussainkalan opened this issue 10 months ago • 0 comments

Setup: Ubuntu 20.04 LTS ROS Noetic

i have used correctly installed the slam karto but after launching this i am only able to see map statically like if i move then its not generating anything, or map does not gets update in real time (so it is fixed)

my graph goes like this

                map (slam_karto)
                |
                └── odom (odom_to_base_link)
                        |
                        └── base_link
                                |
                                ├── laser (base_link_to_laser)
                                └── imu (imu_filter)

here is my launch file of static transform

<launch>
   <node pkg="tf2_ros" type="static_transform_publisher" name="odom_to_base_link" args="0 0 0 0 0 0 /odom /base_link ">        
    <node pkg="tf2_ros" type="static_transform_publisher" name="base_link_to_laser_link" args="0 0 0 0 0 0 /base_link /laser ">
</launch>

and this is my slam karto launch file

<launch>

<param name="/use_sim_time" value="false" />
  <node pkg="slam_karto" type="slam_karto" name="slam_karto" output="screen">
    <param name="scan_topic" value="scan" />
    <param name="odom_frame" value="odom"/>
    <param name="map_update_interval" value="15"/>
    <param name="resolution" value="0.025"/>
    <param name="range_threshold" value="12.0" />
    <param name="use_scan_matching" value="true" />
  </node>
</launch>

saqihussainkalan avatar Apr 16 '24 02:04 saqihussainkalan