Packages

Name Description
1 2019-03-27 hardware_interface
Hardware Interface base class.
Hardware Interface base class.
 
1 hayai
1 head_action
1 head_pose_estimation
1 2019-05-20 health_metric_collector
The health_metric_collector package
The health_metric_collector package
 
1 heatmap
1 2019-01-29 hebi_cpp_api
A ROS package providing access to the HEBI C++ API.
A ROS package providing access to the HEBI C++ API.
 
1 hebiros
1 hebiros_advanced_examples
1 hebiros_basic_examples
1 hebiros_description
1 hebiros_gazebo_plugin
1 hector_barrel_detection_nodelet
1 hector_barrel_geotiff_plugin
1 hector_co2_detection_plugin
1 hector_co2_processing
1 2019-05-16 hector_components_description
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
 
1 2018-06-07 hector_compressed_map_transport
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
 
1 2019-05-01 hector_costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
 
1 2019-05-01 hector_driving_aid_markers
The hector_driving_aid_markers package
The hector_driving_aid_markers package
 
1 2019-05-01 hector_elevation_mapping
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
 
1 2019-05-01 hector_elevation_msgs
The hector_elevation_msgs package contains messages for hector_elevation_mapping and hector_elevation_visualization packages.
The hector_elevation_msgs package contains messages for hector_elevation_mapping and hector_elevation_visualization packages.
 
1 2019-05-01 hector_elevation_visualization
The hector_elevation_visualization package
The hector_elevation_visualization package
 
1 2019-05-01 hector_exploration_controller
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
 
1 2019-05-01 hector_exploration_node
hector_exploration_node is a node that provides exploration plans via a service server
hector_exploration_node is a node that provides exploration plans via a service server
 
1 2019-05-01 hector_exploration_planner
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
 
1 2018-11-22 hector_gazebo
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
 
1 2018-11-22 hector_gazebo_plugins
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
 
1 2018-11-22 hector_gazebo_thermal_camera
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
 
1 2018-11-22 hector_gazebo_worlds
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
 
1 2018-06-07 hector_geotiff
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
 
1 2018-06-07 hector_geotiff_plugins
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
 
1 2019-05-01 hector_gps_calibration
The hector_gps_calibration package
The hector_gps_calibration package
 
1 hector_heat_detection
1 2018-06-07 hector_imu_attitude_to_tf
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
 
1 2018-06-07 hector_imu_tools
hector_imu_tools provides some tools for processing IMU messages
hector_imu_tools provides some tools for processing IMU messages
 
1 hector_localization
1 2018-06-07 hector_map_server
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
 
1 2018-06-07 hector_map_tools
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
 
1 2018-06-07 hector_mapping
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.
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.
 
0 hector_mapstitch
1 2018-06-07 hector_marker_drawing
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
 
1 2019-05-16 hector_models
hector_models contains (urdf) models of robots, sensors etc.
hector_models contains (urdf) models of robots, sensors etc.
 
1 hector_motion_detection
1 2018-06-07 hector_nav_msgs
hector_nav_msgs contains messages and services used in the hector_slam stack.
hector_nav_msgs contains messages and services used in the hector_slam stack.
 
1 hector_nist_arena_designer
1 hector_nist_arena_elements
1 hector_nist_arena_worlds
1 hector_object_tracker
1 2019-05-01 hector_path_follower
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
 

Packages

Name Description
1 2018-10-09 hardware_interface
Hardware Interface base class.
Hardware Interface base class.
 
1 hayai
1 head_action
1 head_pose_estimation
1 health_metric_collector
1 heatmap
1 hebi_cpp_api
1 hebiros
1 hebiros_advanced_examples
1 hebiros_basic_examples
1 hebiros_description
1 hebiros_gazebo_plugin
1 hector_barrel_detection_nodelet
1 hector_barrel_geotiff_plugin
1 hector_co2_detection_plugin
1 hector_co2_processing
1 2019-05-16 hector_components_description
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
 
1 hector_compressed_map_transport
1 hector_costmap
1 hector_driving_aid_markers
1 hector_elevation_mapping
1 hector_elevation_msgs
1 hector_elevation_visualization
1 hector_exploration_controller
1 hector_exploration_node
1 hector_exploration_planner
1 2018-11-22 hector_gazebo
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
 
1 2018-11-22 hector_gazebo_plugins
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
 
1 2018-11-22 hector_gazebo_thermal_camera
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
 
1 2018-11-22 hector_gazebo_worlds
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
 
1 hector_geotiff
1 hector_geotiff_plugins
1 hector_gps_calibration
1 hector_heat_detection
1 hector_imu_attitude_to_tf
1 hector_imu_tools
1 hector_localization
1 hector_map_server
1 hector_map_tools
1 hector_mapping
0 hector_mapstitch
1 hector_marker_drawing
1 2019-05-16 hector_models
hector_models contains (urdf) models of robots, sensors etc.
hector_models contains (urdf) models of robots, sensors etc.
 
1 hector_motion_detection
1 hector_nav_msgs
1 hector_nist_arena_designer
1 hector_nist_arena_elements
1 hector_nist_arena_worlds
1 hector_object_tracker
1 hector_path_follower

Packages

Name Description
1 2018-10-09 hardware_interface
Hardware Interface base class.
Hardware Interface base class.
 
1 hayai
1 head_action
1 head_pose_estimation
1 2019-05-20 health_metric_collector
The health_metric_collector package
The health_metric_collector package
 
1 heatmap
1 2019-01-29 hebi_cpp_api
A ROS package providing access to the HEBI C++ API.
A ROS package providing access to the HEBI C++ API.
 
1 2019-01-30 hebiros
The hebiros package
The hebiros package
 
1 2019-01-30 hebiros_advanced_examples
Advanced examples for hebiros with additional dependencies
Advanced examples for hebiros with additional dependencies
 
1 2019-01-30 hebiros_basic_examples
Basic examples for hebiros with no additional dependencies
Basic examples for hebiros with no additional dependencies
 
1 2019-01-30 hebiros_description
Models for HEBI components and hebiros
Models for HEBI components and hebiros
 
1 2019-01-30 hebiros_gazebo_plugin
The hebiros_gazebo_plugin package
The hebiros_gazebo_plugin package
 
1 2016-08-12 hector_barrel_detection_nodelet
The hector_barrel_detection_nodelet package
The hector_barrel_detection_nodelet package
 
1 2016-08-12 hector_barrel_geotiff_plugin
The hector_barrel_geotiff_plugin package
The hector_barrel_geotiff_plugin package
 
1 2016-08-12 hector_co2_detection_plugin
The hector_co2_detection_plugin package
The hector_co2_detection_plugin package
 
1 2016-08-12 hector_co2_processing
The hector_co2_processing package
The hector_co2_processing package
 
1 2019-05-16 hector_components_description
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
 
1 2018-06-07 hector_compressed_map_transport
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
 
1 2019-05-06 hector_costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
 
1 2019-05-06 hector_driving_aid_markers
The hector_driving_aid_markers package
The hector_driving_aid_markers package
 
1 2019-05-06 hector_elevation_mapping
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
 
1 2019-05-06 hector_elevation_msgs
The hector_elevation_msgs package contains messages for hector_elevation_mapping and hector_elevation_visualization packages.
The hector_elevation_msgs package contains messages for hector_elevation_mapping and hector_elevation_visualization packages.
 
1 2019-05-06 hector_elevation_visualization
The hector_elevation_visualization package
The hector_elevation_visualization package
 
1 2019-05-06 hector_exploration_controller
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
 
1 2019-05-06 hector_exploration_node
hector_exploration_node is a node that provides exploration plans via a service server
hector_exploration_node is a node that provides exploration plans via a service server
 
1 2019-05-06 hector_exploration_planner
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
 
1 2018-11-22 hector_gazebo
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
 
1 2018-11-22 hector_gazebo_plugins
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
 
1 2018-11-22 hector_gazebo_thermal_camera
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
 
1 2018-11-22 hector_gazebo_worlds
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
 
1 2018-06-07 hector_geotiff
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
 
1 2018-06-07 hector_geotiff_plugins
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
 
1 2019-05-06 hector_gps_calibration
The hector_gps_calibration package
The hector_gps_calibration package
 
1 2016-02-01 hector_heat_detection
hector_heat_detection searches for image regions within a specific temperature range. The heat_detection node publishes hector_worldmodel_msgs/ImagePercept messages and serves as an source of input for the
hector_heat_detection searches for image regions within a specific temperature range. The heat_detection node publishes hector_worldmodel_msgs/ImagePercept messages and serves as an source of input for the
 
1 2018-06-07 hector_imu_attitude_to_tf
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
 
1 2018-06-07 hector_imu_tools
hector_imu_tools provides some tools for processing IMU messages
hector_imu_tools provides some tools for processing IMU messages
 
1 2018-06-07 hector_localization
The hector_localization stack is a collection of packages, that provide the full 6DOF pose of a robot or platform. It uses various sensor sources, which are fused using an Extended Kalman filter. Acceleration and angular rates from an inertial measurement unit (IMU) serve as primary measurements. The usage of other sensors is application-dependent. The hector_localization stack currently supports GPS, magnetometer, barometric pressure sensors and other external sources that provide a geometry_msgs/PoseWithCovariance message via the poseupdate topic.
The hector_localization stack is a collection of packages, that provide the full 6DOF pose of a robot or platform. It uses various sensor sources, which are fused using an Extended Kalman filter. Acceleration and angular rates from an inertial measurement unit (IMU) serve as primary measurements. The usage of other sensors is application-dependent. The hector_localization stack currently supports GPS, magnetometer, barometric pressure sensors and other external sources that provide a geometry_msgs/PoseWithCovariance message via the poseupdate topic.
 
1 2018-06-07 hector_map_server
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
 
1 2018-06-07 hector_map_tools
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
 
1 2018-06-07 hector_mapping
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.
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.
 
0 hector_mapstitch
1 2018-06-07 hector_marker_drawing
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
 
1 2019-05-16 hector_models
hector_models contains (urdf) models of robots, sensors etc.
hector_models contains (urdf) models of robots, sensors etc.
 
1 2016-02-01 hector_motion_detection
hector_motion_detection
hector_motion_detection
 
1 2018-06-07 hector_nav_msgs
hector_nav_msgs contains messages and services used in the hector_slam stack.
hector_nav_msgs contains messages and services used in the hector_slam stack.
 
1 2019-05-13 hector_nist_arena_designer
hector_nist_arena_designer is a simple GUI for the fast and easy creation of test scenarios involving NIST standard test methods for response robots.
hector_nist_arena_designer is a simple GUI for the fast and easy creation of test scenarios involving NIST standard test methods for response robots.
 
1 2019-05-13 hector_nist_arena_elements
hector_nist_arena_elements contains models of elements/parts used in NIST standard test arenas for response robots. Using these elements, scenarios can be generated for simulation using gazebo.
hector_nist_arena_elements contains models of elements/parts used in NIST standard test arenas for response robots. Using these elements, scenarios can be generated for simulation using gazebo.
 
1 2019-05-13 hector_nist_arena_worlds
hector_nist_arena_worlds by default contains NIST standard test arena scenarios created using the hector_nist_arena_designer GUI.
hector_nist_arena_worlds by default contains NIST standard test arena scenarios created using the hector_nist_arena_designer GUI.
 
1 2016-06-24 hector_object_tracker
hector_object_tracker is the core package of hector_worldmodel. It listens to percept message from detectors (e.g. heat signatures of persons or recognitions of other objects of interest in the scene) and fuses all information to a single worldmodel state. Objects will be tracked over time and their states can be influenced by a couple of services. The percept to object association problem is solved either automatically based on the Mahalanobis distance, or a unique object_id can be given in the percept message. If a hector_nav_msgs/GetDistanceToObstacle service is available, the object_tracker can optionally deduce the depth of objects in the scene by projection to the nearest obstacle (wall).
hector_object_tracker is the core package of hector_worldmodel. It listens to percept message from detectors (e.g. heat signatures of persons or recognitions of other objects of interest in the scene) and fuses all information to a single worldmodel state. Objects will be tracked over time and their states can be influenced by a couple of services. The percept to object association problem is solved either automatically based on the Mahalanobis distance, or a unique object_id can be given in the percept message. If a hector_nav_msgs/GetDistanceToObstacle service is available, the object_tracker can optionally deduce the depth of objects in the scene by projection to the nearest obstacle (wall).
 
1 2019-05-06 hector_path_follower
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
 

Packages

Name Description
1 2018-05-31 hardware_interface
Hardware Interface base class.
Hardware Interface base class.
 
1 2018-10-10 hayai
The hayai catkin package
The hayai catkin package
 
1 2017-03-15 head_action
The head action is a node that provides an action interface for pointing the head of the configured robot. It passes trajectory goals to the controller, and reports success when they have finished executing.
The head action is a node that provides an action interface for pointing the head of the configured robot. It passes trajectory goals to the controller, and reports success when they have finished executing.
 
1 2014-11-11 head_pose_estimation
ROS wrapper around Fanelli et al.'s Real Time Head Pose Estimation from Consumer Depth Cameras. 33rd Annual Symposium of the German Association for Pattern Recognition (DAGM'11), 2011.
ROS wrapper around Fanelli et al.'s Real Time Head Pose Estimation from Consumer Depth Cameras. 33rd Annual Symposium of the German Association for Pattern Recognition (DAGM'11), 2011.
 
1 health_metric_collector
1 heatmap
1 hebi_cpp_api
1 hebiros
1 hebiros_advanced_examples
1 hebiros_basic_examples
1 hebiros_description
1 hebiros_gazebo_plugin
1 2016-08-12 hector_barrel_detection_nodelet
The hector_barrel_detection_nodelet package
The hector_barrel_detection_nodelet package
 
1 2016-08-12 hector_barrel_geotiff_plugin
The hector_barrel_geotiff_plugin package
The hector_barrel_geotiff_plugin package
 
1 2016-08-12 hector_co2_detection_plugin
The hector_co2_detection_plugin package
The hector_co2_detection_plugin package
 
1 2016-08-12 hector_co2_processing
The hector_co2_processing package
The hector_co2_processing package
 
1 2018-03-12 hector_components_description
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
 
1 2018-06-07 hector_compressed_map_transport
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
 
1 2019-05-06 hector_costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
 
1 2019-05-06 hector_driving_aid_markers
The hector_driving_aid_markers package
The hector_driving_aid_markers package
 
1 2019-05-06 hector_elevation_mapping
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
 
1 2019-05-06 hector_elevation_msgs
The hector_elevation_msgs package contains messages for hector_elevation_mapping and hector_elevation_visualization packages.
The hector_elevation_msgs package contains messages for hector_elevation_mapping and hector_elevation_visualization packages.
 
1 2019-05-06 hector_elevation_visualization
The hector_elevation_visualization package
The hector_elevation_visualization package
 
1 2019-05-06 hector_exploration_controller
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
 
1 2019-05-06 hector_exploration_node
hector_exploration_node is a node that provides exploration plans via a service server
hector_exploration_node is a node that provides exploration plans via a service server
 
1 2019-05-06 hector_exploration_planner
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
 
1 2016-06-24 hector_gazebo
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
 
1 2016-06-24 hector_gazebo_plugins
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
 
1 2016-06-24 hector_gazebo_thermal_camera
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
 
1 2016-06-24 hector_gazebo_worlds
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
 
1 2018-06-07 hector_geotiff
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
 
1 2018-06-07 hector_geotiff_plugins
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
 
1 2019-05-06 hector_gps_calibration
The hector_gps_calibration package
The hector_gps_calibration package
 
1 2016-02-01 hector_heat_detection
hector_heat_detection searches for image regions within a specific temperature range. The heat_detection node publishes hector_worldmodel_msgs/ImagePercept messages and serves as an source of input for the
hector_heat_detection searches for image regions within a specific temperature range. The heat_detection node publishes hector_worldmodel_msgs/ImagePercept messages and serves as an source of input for the
 
1 2018-06-07 hector_imu_attitude_to_tf
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
 
1 2018-06-07 hector_imu_tools
hector_imu_tools provides some tools for processing IMU messages
hector_imu_tools provides some tools for processing IMU messages
 
1 2018-06-07 hector_localization
The hector_localization stack is a collection of packages, that provide the full 6DOF pose of a robot or platform. It uses various sensor sources, which are fused using an Extended Kalman filter. Acceleration and angular rates from an inertial measurement unit (IMU) serve as primary measurements. The usage of other sensors is application-dependent. The hector_localization stack currently supports GPS, magnetometer, barometric pressure sensors and other external sources that provide a geometry_msgs/PoseWithCovariance message via the poseupdate topic.
The hector_localization stack is a collection of packages, that provide the full 6DOF pose of a robot or platform. It uses various sensor sources, which are fused using an Extended Kalman filter. Acceleration and angular rates from an inertial measurement unit (IMU) serve as primary measurements. The usage of other sensors is application-dependent. The hector_localization stack currently supports GPS, magnetometer, barometric pressure sensors and other external sources that provide a geometry_msgs/PoseWithCovariance message via the poseupdate topic.
 
1 2018-06-07 hector_map_server
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
 
1 2018-06-07 hector_map_tools
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
 
1 2018-06-07 hector_mapping
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.
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.
 
0 hector_mapstitch
1 2018-06-07 hector_marker_drawing
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
 
1 2018-03-12 hector_models
hector_models contains (urdf) models of robots, sensors etc.
hector_models contains (urdf) models of robots, sensors etc.
 
1 2016-02-01 hector_motion_detection
hector_motion_detection
hector_motion_detection
 
1 2018-06-07 hector_nav_msgs
hector_nav_msgs contains messages and services used in the hector_slam stack.
hector_nav_msgs contains messages and services used in the hector_slam stack.
 
1 2019-05-13 hector_nist_arena_designer
hector_nist_arena_designer is a simple GUI for the fast and easy creation of test scenarios involving NIST standard test methods for response robots.
hector_nist_arena_designer is a simple GUI for the fast and easy creation of test scenarios involving NIST standard test methods for response robots.
 
1 2019-05-13 hector_nist_arena_elements
hector_nist_arena_elements contains models of elements/parts used in NIST standard test arenas for response robots. Using these elements, scenarios can be generated for simulation using gazebo.
hector_nist_arena_elements contains models of elements/parts used in NIST standard test arenas for response robots. Using these elements, scenarios can be generated for simulation using gazebo.
 
1 2019-05-13 hector_nist_arena_worlds
hector_nist_arena_worlds by default contains NIST standard test arena scenarios created using the hector_nist_arena_designer GUI.
hector_nist_arena_worlds by default contains NIST standard test arena scenarios created using the hector_nist_arena_designer GUI.
 
1 2016-06-24 hector_object_tracker
hector_object_tracker is the core package of hector_worldmodel. It listens to percept message from detectors (e.g. heat signatures of persons or recognitions of other objects of interest in the scene) and fuses all information to a single worldmodel state. Objects will be tracked over time and their states can be influenced by a couple of services. The percept to object association problem is solved either automatically based on the Mahalanobis distance, or a unique object_id can be given in the percept message. If a hector_nav_msgs/GetDistanceToObstacle service is available, the object_tracker can optionally deduce the depth of objects in the scene by projection to the nearest obstacle (wall).
hector_object_tracker is the core package of hector_worldmodel. It listens to percept message from detectors (e.g. heat signatures of persons or recognitions of other objects of interest in the scene) and fuses all information to a single worldmodel state. Objects will be tracked over time and their states can be influenced by a couple of services. The percept to object association problem is solved either automatically based on the Mahalanobis distance, or a unique object_id can be given in the percept message. If a hector_nav_msgs/GetDistanceToObstacle service is available, the object_tracker can optionally deduce the depth of objects in the scene by projection to the nearest obstacle (wall).
 
1 2019-05-06 hector_path_follower
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
 

Packages

Name Description
1 2016-11-28 hardware_interface
Hardware Interface base class.
Hardware Interface base class.
 
1 hayai
1 head_action
1 2014-11-11 head_pose_estimation
ROS wrapper around Fanelli et al.'s Real Time Head Pose Estimation from Consumer Depth Cameras. 33rd Annual Symposium of the German Association for Pattern Recognition (DAGM'11), 2011.
ROS wrapper around Fanelli et al.'s Real Time Head Pose Estimation from Consumer Depth Cameras. 33rd Annual Symposium of the German Association for Pattern Recognition (DAGM'11), 2011.
 
1 health_metric_collector
1 2015-08-29 heatmap
The heatmap package allows you to create a WIFI-heatmap
The heatmap package allows you to create a WIFI-heatmap
 
1 hebi_cpp_api
1 hebiros
1 hebiros_advanced_examples
1 hebiros_basic_examples
1 hebiros_description
1 hebiros_gazebo_plugin
1 2016-08-12 hector_barrel_detection_nodelet
The hector_barrel_detection_nodelet package
The hector_barrel_detection_nodelet package
 
1 2016-08-12 hector_barrel_geotiff_plugin
The hector_barrel_geotiff_plugin package
The hector_barrel_geotiff_plugin package
 
1 2016-08-12 hector_co2_detection_plugin
The hector_co2_detection_plugin package
The hector_co2_detection_plugin package
 
1 2016-08-12 hector_co2_processing
The hector_co2_processing package
The hector_co2_processing package
 
1 2016-06-24 hector_components_description
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
 
1 2018-06-07 hector_compressed_map_transport
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
 
1 2019-05-06 hector_costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
 
1 2019-05-06 hector_driving_aid_markers
The hector_driving_aid_markers package
The hector_driving_aid_markers package
 
1 2019-05-06 hector_elevation_mapping
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
 
1 2019-05-06 hector_elevation_msgs
The hector_elevation_msgs package contains messages for hector_elevation_mapping and hector_elevation_visualization packages.
The hector_elevation_msgs package contains messages for hector_elevation_mapping and hector_elevation_visualization packages.
 
1 2019-05-06 hector_elevation_visualization
The hector_elevation_visualization package
The hector_elevation_visualization package
 
1 2019-05-06 hector_exploration_controller
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
 
1 2019-05-06 hector_exploration_node
hector_exploration_node is a node that provides exploration plans via a service server
hector_exploration_node is a node that provides exploration plans via a service server
 
1 2019-05-06 hector_exploration_planner
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
 
1 2016-06-24 hector_gazebo
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
 
1 2016-06-24 hector_gazebo_plugins
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
 
1 2016-06-24 hector_gazebo_thermal_camera
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
 
1 2016-06-24 hector_gazebo_worlds
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
 
1 2018-06-07 hector_geotiff
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
 
1 2018-06-07 hector_geotiff_plugins
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
 
1 2019-05-06 hector_gps_calibration
The hector_gps_calibration package
The hector_gps_calibration package
 
1 2016-02-01 hector_heat_detection
hector_heat_detection searches for image regions within a specific temperature range. The heat_detection node publishes hector_worldmodel_msgs/ImagePercept messages and serves as an source of input for the
hector_heat_detection searches for image regions within a specific temperature range. The heat_detection node publishes hector_worldmodel_msgs/ImagePercept messages and serves as an source of input for the
 
1 2018-06-07 hector_imu_attitude_to_tf
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
 
1 2018-06-07 hector_imu_tools
hector_imu_tools provides some tools for processing IMU messages
hector_imu_tools provides some tools for processing IMU messages
 
1 2018-06-07 hector_localization
The hector_localization stack is a collection of packages, that provide the full 6DOF pose of a robot or platform. It uses various sensor sources, which are fused using an Extended Kalman filter. Acceleration and angular rates from an inertial measurement unit (IMU) serve as primary measurements. The usage of other sensors is application-dependent. The hector_localization stack currently supports GPS, magnetometer, barometric pressure sensors and other external sources that provide a geometry_msgs/PoseWithCovariance message via the poseupdate topic.
The hector_localization stack is a collection of packages, that provide the full 6DOF pose of a robot or platform. It uses various sensor sources, which are fused using an Extended Kalman filter. Acceleration and angular rates from an inertial measurement unit (IMU) serve as primary measurements. The usage of other sensors is application-dependent. The hector_localization stack currently supports GPS, magnetometer, barometric pressure sensors and other external sources that provide a geometry_msgs/PoseWithCovariance message via the poseupdate topic.
 
1 2018-06-07 hector_map_server
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
 
1 2018-06-07 hector_map_tools
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
 
1 2018-06-07 hector_mapping
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.
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.
 
0 hector_mapstitch
1 2018-06-07 hector_marker_drawing
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
 
1 2016-06-24 hector_models
hector_models contains (urdf) models of robots, sensors etc.
hector_models contains (urdf) models of robots, sensors etc.
 
1 2016-02-01 hector_motion_detection
hector_motion_detection
hector_motion_detection
 
1 2018-06-07 hector_nav_msgs
hector_nav_msgs contains messages and services used in the hector_slam stack.
hector_nav_msgs contains messages and services used in the hector_slam stack.
 
1 2019-05-13 hector_nist_arena_designer
hector_nist_arena_designer is a simple GUI for the fast and easy creation of test scenarios involving NIST standard test methods for response robots.
hector_nist_arena_designer is a simple GUI for the fast and easy creation of test scenarios involving NIST standard test methods for response robots.
 
1 2019-05-13 hector_nist_arena_elements
hector_nist_arena_elements contains models of elements/parts used in NIST standard test arenas for response robots. Using these elements, scenarios can be generated for simulation using gazebo.
hector_nist_arena_elements contains models of elements/parts used in NIST standard test arenas for response robots. Using these elements, scenarios can be generated for simulation using gazebo.
 
1 2019-05-13 hector_nist_arena_worlds
hector_nist_arena_worlds by default contains NIST standard test arena scenarios created using the hector_nist_arena_designer GUI.
hector_nist_arena_worlds by default contains NIST standard test arena scenarios created using the hector_nist_arena_designer GUI.
 
1 2016-06-24 hector_object_tracker
hector_object_tracker is the core package of hector_worldmodel. It listens to percept message from detectors (e.g. heat signatures of persons or recognitions of other objects of interest in the scene) and fuses all information to a single worldmodel state. Objects will be tracked over time and their states can be influenced by a couple of services. The percept to object association problem is solved either automatically based on the Mahalanobis distance, or a unique object_id can be given in the percept message. If a hector_nav_msgs/GetDistanceToObstacle service is available, the object_tracker can optionally deduce the depth of objects in the scene by projection to the nearest obstacle (wall).
hector_object_tracker is the core package of hector_worldmodel. It listens to percept message from detectors (e.g. heat signatures of persons or recognitions of other objects of interest in the scene) and fuses all information to a single worldmodel state. Objects will be tracked over time and their states can be influenced by a couple of services. The percept to object association problem is solved either automatically based on the Mahalanobis distance, or a unique object_id can be given in the percept message. If a hector_nav_msgs/GetDistanceToObstacle service is available, the object_tracker can optionally deduce the depth of objects in the scene by projection to the nearest obstacle (wall).
 
1 2019-05-06 hector_path_follower
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
 

Packages

Name Description
1 2014-10-28 hardware_interface
Hardware Interface base class.
Hardware Interface base class.
 
1 hayai
1 2014-09-11 head_action
The head action is a node that provides an action interface for pointing the head of the configured robot. It passes trajectory goals to the controller, and reports success when they have finished executing.
The head action is a node that provides an action interface for pointing the head of the configured robot. It passes trajectory goals to the controller, and reports success when they have finished executing.
 
1 2014-11-11 head_pose_estimation
ROS wrapper around Fanelli et al.'s Real Time Head Pose Estimation from Consumer Depth Cameras. 33rd Annual Symposium of the German Association for Pattern Recognition (DAGM'11), 2011.
ROS wrapper around Fanelli et al.'s Real Time Head Pose Estimation from Consumer Depth Cameras. 33rd Annual Symposium of the German Association for Pattern Recognition (DAGM'11), 2011.
 
1 health_metric_collector
1 heatmap
1 hebi_cpp_api
1 hebiros
1 hebiros_advanced_examples
1 hebiros_basic_examples
1 hebiros_description
1 hebiros_gazebo_plugin
1 2016-08-12 hector_barrel_detection_nodelet
The hector_barrel_detection_nodelet package
The hector_barrel_detection_nodelet package
 
1 2016-08-12 hector_barrel_geotiff_plugin
The hector_barrel_geotiff_plugin package
The hector_barrel_geotiff_plugin package
 
1 2016-08-12 hector_co2_detection_plugin
The hector_co2_detection_plugin package
The hector_co2_detection_plugin package
 
1 2016-08-12 hector_co2_processing
The hector_co2_processing package
The hector_co2_processing package
 
1 2015-07-17 hector_components_description
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
hector_components_description contains URDF xacro macros for robot components, so they are easily attachable to robot models.
 
1 2018-06-07 hector_compressed_map_transport
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
hector_compressed_map_transport provides means for transporting compressed map data through the use of image_transport.
 
1 2015-04-24 hector_costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
hector_costmap provides a 2D occupancy grid map containing all untraversable obstacles. It fuses 2.5D elevation map (provided by hector_elevation_mapping) with the 2D occupancy grid map (provided by hector_slam) for calculating the 2D costmap
 
1 2015-04-24 hector_driving_aid_markers
hector_driving_aid_markers
hector_driving_aid_markers
 
1 2015-04-24 hector_elevation_mapping
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
hector_elevation_mapping advertises pointclouds and generates a local and/or global 2.5D elevation map
 
1 2015-04-24 hector_elevation_msgs
elevation_msgs contains messages for hector_elevation_mapping and hector_elevation_visualization packages
elevation_msgs contains messages for hector_elevation_mapping and hector_elevation_visualization packages
 
1 2015-04-24 hector_elevation_visualization
hector_elevation_visualization is an tool for visualization of elevation maps generated by the hector_elevation_mapping package
hector_elevation_visualization is an tool for visualization of elevation maps generated by the hector_elevation_mapping package
 
1 2015-04-24 hector_exploration_controller
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
hector_exploration_controller is a simple controller that requests a plan via a service and generates geometry_msgs/Twist commands accordingly to follow this plan
 
1 2015-04-24 hector_exploration_node
hector_exploration_node is a node that provides exploration plans via a service server
hector_exploration_node is a node that provides exploration plans via a service server
 
1 2015-04-24 hector_exploration_planner
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
hector_exploration_planner is a planner that can both plan paths to goal points and generate goals to explore unknown environments
 
1 2015-09-07 hector_gazebo
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
hector_gazebo provides packages related to to simulation of robots using gazebo (gazebo plugins, world files etc.)
 
1 2015-09-07 hector_gazebo_plugins
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
hector_gazebo_plugins provides gazebo plugins from Team Hector. Currently it contains a 6wd differential drive plugin, an IMU sensor plugin, an earth magnetic field sensor plugin, a GPS sensor plugin and a sonar ranger plugin.
 
1 2015-09-07 hector_gazebo_thermal_camera
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
hector_gazebo_thermal_camera provides a gazebo plugin that produces simulated thermal camera images. The plugin uses modified code from the gazebo_ros_camera plugin.
 
1 2015-09-07 hector_gazebo_worlds
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
hector_gazebo_worlds provides gazebo scenarios used by Team Hector Darmstadt
 
1 2018-06-07 hector_geotiff
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
hector_geotiff provides a node that can be used to save occupancy grid map, robot trajectory and object of interest data to RoboCup Rescue compliant GeoTiff images.
 
1 2018-06-07 hector_geotiff_plugins
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
hector_geotiff_plugins contains plugins that extend geotiff maps generated by hector_geotiff.
 
1 hector_gps_calibration
1 2016-02-01 hector_heat_detection
hector_heat_detection searches for image regions within a specific temperature range. The heat_detection node publishes hector_worldmodel_msgs/ImagePercept messages and serves as an source of input for the
hector_heat_detection searches for image regions within a specific temperature range. The heat_detection node publishes hector_worldmodel_msgs/ImagePercept messages and serves as an source of input for the
 
1 2018-06-07 hector_imu_attitude_to_tf
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
hector_imu_attitude_to_tf is a lightweight node that can be used to publish the roll/pitch attitude angles reported via a imu message to tf.
 
1 2018-06-07 hector_imu_tools
hector_imu_tools provides some tools for processing IMU messages
hector_imu_tools provides some tools for processing IMU messages
 
1 2018-06-07 hector_localization
The hector_localization stack is a collection of packages, that provide the full 6DOF pose of a robot or platform. It uses various sensor sources, which are fused using an Extended Kalman filter. Acceleration and angular rates from an inertial measurement unit (IMU) serve as primary measurements. The usage of other sensors is application-dependent. The hector_localization stack currently supports GPS, magnetometer, barometric pressure sensors and other external sources that provide a geometry_msgs/PoseWithCovariance message via the poseupdate topic.
The hector_localization stack is a collection of packages, that provide the full 6DOF pose of a robot or platform. It uses various sensor sources, which are fused using an Extended Kalman filter. Acceleration and angular rates from an inertial measurement unit (IMU) serve as primary measurements. The usage of other sensors is application-dependent. The hector_localization stack currently supports GPS, magnetometer, barometric pressure sensors and other external sources that provide a geometry_msgs/PoseWithCovariance message via the poseupdate topic.
 
1 2018-06-07 hector_map_server
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
hector_map_server provides a service for retrieving the map, as well as for raycasting based obstacle queries (finds next obstacle in the map, given start and endpoint in any tf coordinate frame).
 
1 2018-06-07 hector_map_tools
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
hector_map_tools contains some functions related to accessing information from OccupancyGridMap maps. Currently consists of a single header.
 
1 2018-06-07 hector_mapping
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.
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.
 
0 hector_mapstitch
1 2018-06-07 hector_marker_drawing
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
hector_marker_drawing provides convenience functions for easier publishing of visualization markers.
 
1 2015-07-17 hector_models
hector_models contains (urdf) models of robots, sensors etc.
hector_models contains (urdf) models of robots, sensors etc.
 
1 2016-02-01 hector_motion_detection
hector_motion_detection
hector_motion_detection
 
1 2018-06-07 hector_nav_msgs
hector_nav_msgs contains messages and services used in the hector_slam stack.
hector_nav_msgs contains messages and services used in the hector_slam stack.
 
1 2015-07-21 hector_nist_arena_designer
hector_nist_arena_designer is a simple GUI for the fast and easy creation of test scenarios involving NIST standard test methods for response robots.
hector_nist_arena_designer is a simple GUI for the fast and easy creation of test scenarios involving NIST standard test methods for response robots.
 
1 2015-07-21 hector_nist_arena_elements
hector_nist_arena_elements contains models of elements/parts used in NIST standard test arenas for response robots. Using these elements, scenarios can be generated for simulation using gazebo.
hector_nist_arena_elements contains models of elements/parts used in NIST standard test arenas for response robots. Using these elements, scenarios can be generated for simulation using gazebo.
 
1 2015-07-21 hector_nist_arena_worlds
hector_nist_arena_worlds by default contains NIST standard test arena scenarios created using the hector_nist_arena_designer GUI.
hector_nist_arena_worlds by default contains NIST standard test arena scenarios created using the hector_nist_arena_designer GUI.
 
1 2016-06-24 hector_object_tracker
hector_object_tracker is the core package of hector_worldmodel. It listens to percept message from detectors (e.g. heat signatures of persons or recognitions of other objects of interest in the scene) and fuses all information to a single worldmodel state. Objects will be tracked over time and their states can be influenced by a couple of services. The percept to object association problem is solved either automatically based on the Mahalanobis distance, or a unique object_id can be given in the percept message. If a hector_nav_msgs/GetDistanceToObstacle service is available, the object_tracker can optionally deduce the depth of objects in the scene by projection to the nearest obstacle (wall).
hector_object_tracker is the core package of hector_worldmodel. It listens to percept message from detectors (e.g. heat signatures of persons or recognitions of other objects of interest in the scene) and fuses all information to a single worldmodel state. Objects will be tracked over time and their states can be influenced by a couple of services. The percept to object association problem is solved either automatically based on the Mahalanobis distance, or a unique object_id can be given in the percept message. If a hector_nav_msgs/GetDistanceToObstacle service is available, the object_tracker can optionally deduce the depth of objects in the scene by projection to the nearest obstacle (wall).
 
1 2015-04-24 hector_path_follower
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package
hector_path_follower provides a node that publishes Twist messages, following a path. Based on the pose_follower package