No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro jazzy. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

hector_mapping package from guyueclass repo

robot_hmi ros1_pyqt5_app class1_ros_qt_demo robot_voice xfei_robot double_arm_demo double_arm_description double_arm_moveit_config double_arm_teach marm_description marm_moveit_config marm_standardfirmata_driver fast_lio livox_ros_driver loam_livox r3live cam_laser_calib pcl_tutorials mbot_description mbot_gazebo mbot_navigation mbot_teleop hector_compressed_map_transport hector_geotiff hector_geotiff_plugins hector_imu_attitude_to_tf hector_imu_tools hector_map_server hector_map_tools hector_mapping hector_marker_drawing hector_nav_msgs hector_slam hector_slam_launch hector_trajectory_server probot_anno_moveit_config probot_demo probot_description probot_anno_ikfast_manipulator_plugin lidar_obstacle_detection qr_tf robot_vision tensorflow_object_detector vision_msgs probot_bringup industrial_core industrial_deprecated industrial_msgs industrial_robot_client industrial_robot_simulator industrial_trajectory_filters industrial_utils simple_message c800_description c800_moveit_config moveit_lerp_motion_planner learning_launch learning_parameter learning_service learning_tf learning_topic limo_base limo_bringup limo_demo limo_description limo_visions ares_description bringup racecar_description turtletrajectory fuzzypid pid_identification pid_tuning pigot_stl_model anymal_b_simple_description laikago_controller laikago_description laikago_gazebo laikago_msgs yobotics_description yobotics_gazebo yobotics_teleop mini_cheetah_urdf gazebo_pkg race_navigation teleop_twist_keyboard webots_controller webots_ros humanoid_msgs humanoid_nav_msgs op3_bringup op3_description op3_gui_demo op3_kinematics_dynamics op3_online_walking_module_msgs op3_walking_module op3_walking_module_msgs op3_webots_controller op3_webots_gui robotis_controller_msgs robotis_framework_common robotis_math

Package Summary

Tags No category tags.
Version 0.3.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/guyuehome/guyueclass.git
VCS Type git
VCS Version main
Last Updated 2024-10-11
Dev Status UNMAINTAINED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

hector_mapping is a SLAM approach that can be used without odometry as well as on platforms that exhibit roll/pitch motion (of the sensor, the platform or both). It leverages the high update rate of modern LIDAR systems like the Hokuyo UTM-30LX and provides 2D pose estimates at scan rate of the sensors (40Hz for the UTM-30LX). While the system does not provide explicit loop closing ability, it is sufficiently accurate for many real world scenarios. The system has successfully been used on Unmanned Ground Robots, Unmanned Surface Vehicles, Handheld Mapping Devices and logged data from quadrotor UAVs.

Additional Links

Maintainers

  • Johannes Meyer

Authors

  • Stefan Kohlbrecher
README
No README found. See repository README.
CHANGELOG

Changelog for package hector_mapping

0.3.5 (2016-06-24)

  • Use the FindEigen3.cmake module provided by Eigen
  • Contributors: Johannes Meyer

0.3.4 (2015-11-07)

0.3.3 (2014-06-15)

0.3.2 (2014-03-30)

0.3.1 (2013-10-09)

  • respect p_map_frame_
  • added changelogs

0.3.0 (2013-08-08)

  • catkinized hector_slam
  • hector_mapping: fixed multi-resolution map scan matching index bug in MapRepMultiMap.h

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/mapping_default.launch
      • tf_map_scanmatch_transform_frame_name [default: scanmatcher_frame]
      • base_frame [default: base_footprint]
      • odom_frame [default: nav]
      • pub_map_odom_transform [default: true]
      • scan_subscriber_queue_size [default: 5]
      • scan_topic [default: scan]
      • map_size [default: 2048]

Services

No service files found

Plugins

No plugins found.

Recent questions tagged hector_mapping at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.5.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/tu-darmstadt-ros-pkg/hector_slam.git
VCS Type git
VCS Version noetic-devel
Last Updated 2024-11-13
Dev Status MAINTAINED
CI status Continuous Integration : 0 / 0
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

hector_mapping is a SLAM approach that can be used without odometry as well as on platforms that exhibit roll/pitch motion (of the sensor, the platform or both). It leverages the high update rate of modern LIDAR systems like the Hokuyo UTM-30LX and provides 2D pose estimates at scan rate of the sensors (40Hz for the UTM-30LX). While the system does not provide explicit loop closing ability, it is sufficiently accurate for many real world scenarios. The system has successfully been used on Unmanned Ground Robots, Unmanned Surface Vehicles, Handheld Mapping Devices and logged data from quadrotor UAVs.

Additional Links

Maintainers

  • Johannes Meyer

Authors

  • Stefan Kohlbrecher
README
No README found. See repository README.
CHANGELOG

Changelog for package hector_mapping

0.5.2 (2021-04-08)

  • Remove tf_conversions as a dependency (#93)
  • Add reset mapping (and pose) service (#87)
    • add service to reset the mapping with a new initial pose
  • Reorganize scanCallback and add comments (#89)
    • Refactor, reformat and comment scanCallback
    • make rosPointCloudToDataContainer void
    • make rosLaserScanToDataContainer void
  • Add pause and reset services to hector_mapping (#86)
    • Add pause and reset services to Hector
  • Contributors: Marcelino Almeida

0.5.1 (2021-01-15)

0.5.0 (2020-12-17)

  • Moved hector_geotiff launch files to separate package to solve cyclic dependency. Clean up for noetic release.
  • Bump CMake version to avoid CMP0048 warning
  • fixed compilation under noetic
  • Contributors: Marius Schnaubelt, Stefan Fabian

0.4.1 (2020-05-15)

  • Remove unnecessary boost signals find_package With Boost >1.69 hector_mapping won't build. Furthermore, hector_mapping doesn't use signals anywhere.
  • Contributors: Sam Pfeiffer

0.3.6 (2019-10-31)

  • Merge pull request #49 from davidbsp/catkin populate child_frame_id in odometry msg
  • Added child_frame_id in hector mapping's odometry msg
  • Contributors: David Portugal, Johannes Meyer

0.3.5 (2016-06-24)

  • Use the FindEigen3.cmake module provided by Eigen
  • Contributors: Johannes Meyer

0.3.4 (2015-11-07)

0.3.3 (2014-06-15)

0.3.2 (2014-03-30)

0.3.1 (2013-10-09)

  • respect p_map_frame_
  • added changelogs

0.3.0 (2013-08-08)

  • catkinized hector_slam
  • hector_mapping: fixed multi-resolution map scan matching index bug in MapRepMultiMap.h

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/mapping_default.launch
      • tf_map_scanmatch_transform_frame_name [default: scanmatcher_frame]
      • base_frame [default: base_footprint]
      • odom_frame [default: nav]
      • pub_map_odom_transform [default: true]
      • scan_subscriber_queue_size [default: 5]
      • scan_topic [default: scan]
      • map_size [default: 2048]

Plugins

No plugins found.

Recent questions tagged hector_mapping at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.
No version for distro galactic. Known supported distros are highlighted in the buttons above.
No version for distro foxy. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.
No version for distro lunar. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 0.3.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/tu-darmstadt-ros-pkg/hector_slam.git
VCS Type git
VCS Version catkin
Last Updated 2019-11-01
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

hector_mapping is a SLAM approach that can be used without odometry as well as on platforms that exhibit roll/pitch motion (of the sensor, the platform or both). It leverages the high update rate of modern LIDAR systems like the Hokuyo UTM-30LX and provides 2D pose estimates at scan rate of the sensors (40Hz for the UTM-30LX). While the system does not provide explicit loop closing ability, it is sufficiently accurate for many real world scenarios. The system has successfully been used on Unmanned Ground Robots, Unmanned Surface Vehicles, Handheld Mapping Devices and logged data from quadrotor UAVs.

Additional Links

Maintainers

  • Johannes Meyer

Authors

  • Stefan Kohlbrecher
README
No README found. See repository README.
CHANGELOG

Changelog for package hector_mapping

0.3.5 (2016-06-24)

  • Use the FindEigen3.cmake module provided by Eigen
  • Contributors: Johannes Meyer

0.3.4 (2015-11-07)

0.3.3 (2014-06-15)

0.3.2 (2014-03-30)

0.3.1 (2013-10-09)

  • respect p_map_frame_
  • added changelogs

0.3.0 (2013-08-08)

  • catkinized hector_slam
  • hector_mapping: fixed multi-resolution map scan matching index bug in MapRepMultiMap.h

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/mapping_default.launch
      • tf_map_scanmatch_transform_frame_name [default: scanmatcher_frame]
      • base_frame [default: base_footprint]
      • odom_frame [default: nav]
      • pub_map_odom_transform [default: true]
      • scan_subscriber_queue_size [default: 5]
      • scan_topic [default: scan]
      • map_size [default: 2048]

Services

No service files found

Plugins

No plugins found.

Recent questions tagged hector_mapping at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.3.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/tu-darmstadt-ros-pkg/hector_slam.git
VCS Type git
VCS Version catkin
Last Updated 2019-11-01
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

hector_mapping is a SLAM approach that can be used without odometry as well as on platforms that exhibit roll/pitch motion (of the sensor, the platform or both). It leverages the high update rate of modern LIDAR systems like the Hokuyo UTM-30LX and provides 2D pose estimates at scan rate of the sensors (40Hz for the UTM-30LX). While the system does not provide explicit loop closing ability, it is sufficiently accurate for many real world scenarios. The system has successfully been used on Unmanned Ground Robots, Unmanned Surface Vehicles, Handheld Mapping Devices and logged data from quadrotor UAVs.

Additional Links

Maintainers

  • Johannes Meyer

Authors

  • Stefan Kohlbrecher
README
No README found. See repository README.
CHANGELOG

Changelog for package hector_mapping

0.3.5 (2016-06-24)

  • Use the FindEigen3.cmake module provided by Eigen
  • Contributors: Johannes Meyer

0.3.4 (2015-11-07)

0.3.3 (2014-06-15)

0.3.2 (2014-03-30)

0.3.1 (2013-10-09)

  • respect p_map_frame_
  • added changelogs

0.3.0 (2013-08-08)

  • catkinized hector_slam
  • hector_mapping: fixed multi-resolution map scan matching index bug in MapRepMultiMap.h

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/mapping_default.launch
      • tf_map_scanmatch_transform_frame_name [default: scanmatcher_frame]
      • base_frame [default: base_footprint]
      • odom_frame [default: nav]
      • pub_map_odom_transform [default: true]
      • scan_subscriber_queue_size [default: 5]
      • scan_topic [default: scan]
      • map_size [default: 2048]

Services

No service files found

Plugins

No plugins found.

Recent questions tagged hector_mapping at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.3.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/tu-darmstadt-ros-pkg/hector_slam.git
VCS Type git
VCS Version catkin
Last Updated 2019-11-01
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

hector_mapping is a SLAM approach that can be used without odometry as well as on platforms that exhibit roll/pitch motion (of the sensor, the platform or both). It leverages the high update rate of modern LIDAR systems like the Hokuyo UTM-30LX and provides 2D pose estimates at scan rate of the sensors (40Hz for the UTM-30LX). While the system does not provide explicit loop closing ability, it is sufficiently accurate for many real world scenarios. The system has successfully been used on Unmanned Ground Robots, Unmanned Surface Vehicles, Handheld Mapping Devices and logged data from quadrotor UAVs.

Additional Links

Maintainers

  • Johannes Meyer

Authors

  • Stefan Kohlbrecher
README
No README found. See repository README.
CHANGELOG

Changelog for package hector_mapping

0.3.5 (2016-06-24)

  • Use the FindEigen3.cmake module provided by Eigen
  • Contributors: Johannes Meyer

0.3.4 (2015-11-07)

0.3.3 (2014-06-15)

0.3.2 (2014-03-30)

0.3.1 (2013-10-09)

  • respect p_map_frame_
  • added changelogs

0.3.0 (2013-08-08)

  • catkinized hector_slam
  • hector_mapping: fixed multi-resolution map scan matching index bug in MapRepMultiMap.h

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/mapping_default.launch
      • tf_map_scanmatch_transform_frame_name [default: scanmatcher_frame]
      • base_frame [default: base_footprint]
      • odom_frame [default: nav]
      • pub_map_odom_transform [default: true]
      • scan_subscriber_queue_size [default: 5]
      • scan_topic [default: scan]
      • map_size [default: 2048]

Services

No service files found

Plugins

No plugins found.

Recent questions tagged hector_mapping at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.3.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/tu-darmstadt-ros-pkg/hector_slam.git
VCS Type git
VCS Version catkin
Last Updated 2019-11-01
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

hector_mapping is a SLAM approach that can be used without odometry as well as on platforms that exhibit roll/pitch motion (of the sensor, the platform or both). It leverages the high update rate of modern LIDAR systems like the Hokuyo UTM-30LX and provides 2D pose estimates at scan rate of the sensors (40Hz for the UTM-30LX). While the system does not provide explicit loop closing ability, it is sufficiently accurate for many real world scenarios. The system has successfully been used on Unmanned Ground Robots, Unmanned Surface Vehicles, Handheld Mapping Devices and logged data from quadrotor UAVs.

Additional Links

Maintainers

  • Johannes Meyer

Authors

  • Stefan Kohlbrecher
README
No README found. See repository README.
CHANGELOG

Changelog for package hector_mapping

0.3.5 (2016-06-24)

  • Use the FindEigen3.cmake module provided by Eigen
  • Contributors: Johannes Meyer

0.3.4 (2015-11-07)

0.3.3 (2014-06-15)

0.3.2 (2014-03-30)

0.3.1 (2013-10-09)

  • respect p_map_frame_
  • added changelogs

0.3.0 (2013-08-08)

  • catkinized hector_slam
  • hector_mapping: fixed multi-resolution map scan matching index bug in MapRepMultiMap.h

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/mapping_default.launch
      • tf_map_scanmatch_transform_frame_name [default: scanmatcher_frame]
      • base_frame [default: base_footprint]
      • odom_frame [default: nav]
      • pub_map_odom_transform [default: true]
      • scan_subscriber_queue_size [default: 5]
      • scan_topic [default: scan]
      • map_size [default: 2048]

Services

No service files found

Plugins

No plugins found.

Recent questions tagged hector_mapping at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.4.1
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/tu-darmstadt-ros-pkg/hector_slam.git
VCS Type git
VCS Version melodic-devel
Last Updated 2022-03-11
Dev Status MAINTAINED
CI status Continuous Integration : 0 / 0
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

hector_mapping is a SLAM approach that can be used without odometry as well as on platforms that exhibit roll/pitch motion (of the sensor, the platform or both). It leverages the high update rate of modern LIDAR systems like the Hokuyo UTM-30LX and provides 2D pose estimates at scan rate of the sensors (40Hz for the UTM-30LX). While the system does not provide explicit loop closing ability, it is sufficiently accurate for many real world scenarios. The system has successfully been used on Unmanned Ground Robots, Unmanned Surface Vehicles, Handheld Mapping Devices and logged data from quadrotor UAVs.

Additional Links

Maintainers

  • Johannes Meyer

Authors

  • Stefan Kohlbrecher
README
No README found. See repository README.
CHANGELOG

Changelog for package hector_mapping

0.3.6 (2019-10-31)

  • Merge pull request #49 from davidbsp/catkin populate child_frame_id in odometry msg
  • Added child_frame_id in hector mapping's odometry msg
  • Contributors: David Portugal, Johannes Meyer

0.4.1 (2020-05-15)

  • Remove unnecessary boost signals find_package With Boost >1.69 hector_mapping won't build. Furthermore, hector_mapping doesn't use signals anywhere.
  • Contributors: Sam Pfeiffer

0.3.5 (2016-06-24)

  • Use the FindEigen3.cmake module provided by Eigen
  • Contributors: Johannes Meyer

0.3.4 (2015-11-07)

0.3.3 (2014-06-15)

0.3.2 (2014-03-30)

0.3.1 (2013-10-09)

  • respect p_map_frame_
  • added changelogs

0.3.0 (2013-08-08)

  • catkinized hector_slam
  • hector_mapping: fixed multi-resolution map scan matching index bug in MapRepMultiMap.h

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/mapping_default.launch
      • tf_map_scanmatch_transform_frame_name [default: scanmatcher_frame]
      • base_frame [default: base_footprint]
      • odom_frame [default: nav]
      • pub_map_odom_transform [default: true]
      • scan_subscriber_queue_size [default: 5]
      • scan_topic [default: scan]
      • map_size [default: 2048]

Plugins

No plugins found.

Recent questions tagged hector_mapping at Robotics Stack Exchange