Packages
Packages
Packages
Packages
Packages
Packages
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2020-01-13 | asr_next_best_view |
This package estimates Next-Best-Views as well as configurations (target positions and orientations) for a robot, where it is most likely to find and recognize searched objects the poses of which have, e.g., been predicted by means of ISM trees.
This package estimates Next-Best-Views as well as configurations (target positions and orientations) for a robot, where it is most likely to find and recognize searched objects the poses of which have, e.g., been predicted by means of ISM trees.
|
|
1 | 2019-11-28 | asr_navfn |
navfn provides a fast interpolated navigation function that can be used to create plans for
a mobile base. The planner assumes a circular robot and operates on a costmap to find a
minimum cost plan from a start point to an end point in a grid. The navigation function is
computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the
near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the
nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for
a mobile base. The planner assumes a circular robot and operates on a costmap to find a
minimum cost plan from a start point to an end point in a grid. The navigation function is
computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the
near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the
nav_core::BaseGlobalPlanner interface specified in
|
|
1 | 2017-12-27 | asr_mild_navigation |
The mild_navigation package. Launchfiles to start the navigation relevant nodes. Parameter for navigation and maps.
The mild_navigation package. Launchfiles to start the navigation relevant nodes. Parameter for navigation and maps.
|
|
1 | 2017-10-02 | asr_mild_kinematic_chain |
This package provides information about the mild's kinematic chain and contains launch-files to publish the chain to a robot_state_publisher
This package provides information about the mild's kinematic chain and contains launch-files to publish the chain to a robot_state_publisher
|
|
1 | 2019-11-17 | asr_mild_calibration_tool |
A tool to calibrate the relative frames between the mild's laserscanner and the cameras
A tool to calibrate the relative frames between the mild's laserscanner and the cameras
|
|
1 | 2017-06-27 | asr_mild_base_launch_files |
This package contains the launch files and different documents needed to start the system
This package contains the launch files and different documents needed to start the system
|
|
1 | 2017-08-29 | asr_mild_base_laserscanner |
This package provides streams of laser scan messages in cartesian coordinates from a planar sick laser scanner.
This package provides streams of laser scan messages in cartesian coordinates from a planar sick laser scanner.
|
|
1 | 2020-02-17 | asr_mild_base_fake_driving |
The asr_mild_base_fake_driving package provides a simulation system for the robot driving. It simulates the desired driven way which is calculated by the navigation.
The asr_mild_base_fake_driving package provides a simulation system for the robot driving. It simulates the desired driven way which is calculated by the navigation.
|
|
1 | 2017-06-27 | asr_mild_base_driving |
This package calculates and publishes the odometry information, transforms the velocity command into differential drive commands and writes it on the mild_base_driving bus
This package calculates and publishes the odometry information, transforms the velocity command into differential drive commands and writes it on the mild_base_driving bus
|
|
1 | 2020-01-06 | asr_lib_pose_prediction_ism |
This package contains classes and algorithms to predict poses of searched objects by the help of a tree of ISMs. It is organized as a library and contains only a small program to evaluate the performance of different algorithms.
This package contains classes and algorithms to predict poses of searched objects by the help of a tree of ISMs. It is organized as a library and contains only a small program to evaluate the performance of different algorithms.
|
|
1 | 2020-01-06 | asr_lib_ism |
This package contains the ROS-independent library which provides the actual scene-recognition functionality of Implicit Shape Model (ISM) trees. It is referred to both by asr_ism for Passive Scene Recognition and by asr_recognizer_prediction_ism for Active Scene Recognition.
This package contains the ROS-independent library which provides the actual scene-recognition functionality of Implicit Shape Model (ISM) trees. It is referred to both by asr_ism for Passive Scene Recognition and by asr_recognizer_prediction_ism for Active Scene Recognition.
|
|
1 | 2017-06-27 | asr_kinematic_chain_optimizer |
This package calculates the best approximation for a kinematic chain's parameters using rosenbrock optimization. For calculation, a layout of the kinematic chain must be provided, as well as a set of transformations between two frames of the chain that has been acquired during calibration.
This package calculates the best approximation for a kinematic chain's parameters using rosenbrock optimization. For calculation, a layout of the kinematic chain must be provided, as well as a set of transformations between two frames of the chain that has been acquired during calibration.
|
|
0 | asr_kinematic_chain_mild | |||
1 | 2017-06-27 | asr_kinematic_chain_dome |
This package provides information about the PbD dome's kinematic chain and contains launch-files to publish the chain to a robot_state_publisher. Available launchfiles are: dome with real PTU, dome with simulated PTU, dome with real PTU and Flock of Birds and additional transformation_publisher from guppy-cameras to the kinect cameras mounted above. It also contains the urdf model.
This package provides information about the PbD dome's kinematic chain and contains launch-files to publish the chain to a robot_state_publisher. Available launchfiles are: dome with real PTU, dome with simulated PTU, dome with real PTU and Flock of Birds and additional transformation_publisher from guppy-cameras to the kinect cameras mounted above. It also contains the urdf model.
|
|
1 | 2017-06-27 | asr_ivt_bridge |
This package is used to convert between ROS messages and IVT images
This package is used to convert between ROS messages and IVT images
|
|
1 | 2019-12-01 | asr_ivt |
Ros wrapper for the Integrated Vision Toolkit (IVT) library (version 1.3.22)
Ros wrapper for the Integrated Vision Toolkit (IVT) library (version 1.3.22)
|
|
1 | 2019-11-03 | asr_ism_visualizations |
This package provides visualization logic for ism data, e.g. visualization with marker in rviz.
This package provides visualization logic for ism data, e.g. visualization with marker in rviz.
|
|
1 | 2020-01-06 | asr_ism |
This package contains nodes which make up the Passive-Scene-Recognition interface to Implicit Shape Model (ISM) trees. The Active-Scene-Recognition interface to ISM trees is located in asr_recognizer_prediction_ism, instead. A short outline of the functionalities provided by the nodes are:
1. Recording of scenes
2. Training of an ISM tree (Implicit shape model tree)
3. Recognition of scenes
4. Visualization of ISM (tree) data
etc.
This package contains nodes which make up the Passive-Scene-Recognition interface to Implicit Shape Model (ISM) trees. The Active-Scene-Recognition interface to ISM trees is located in asr_recognizer_prediction_ism, instead. A short outline of the functionalities provided by the nodes are:
1. Recording of scenes
2. Training of an ISM tree (Implicit shape model tree)
3. Recognition of scenes
4. Visualization of ISM (tree) data
etc.
|
|
1 | 2019-11-18 | asr_intermediate_object_generator |
The intermediate object generator generates intermediate objects for a domain composed from scenes.
It is used to restrain the amount of objects searched during the direct search phase by selecting appropriate objects to search.
The intermediate object generator generates intermediate objects for a domain composed from scenes.
It is used to restrain the amount of objects searched during the direct search phase by selecting appropriate objects to search.
|
|
1 | 2020-06-16 | asr_halcon_bridge |
This package is used to convert between image-messages of the ROS environment and HALCON-images.
This package is used to convert between image-messages of the ROS environment and HALCON-images.
|
|
1 | 2019-11-18 | asr_grid_creator |
This package can generate a grid for the current map. Each grid_point
defines a position where the robot has to move to. The grid can be used
later on in the asr_direct_search_manager as a basis to generate poses to
search the map. At each grid_point the robot will search around him. All
gird_points together should cover the map.
This package can generate a grid for the current map. Each grid_point
defines a position where the robot has to move to. The grid can be used
later on in the asr_direct_search_manager as a basis to generate poses to
search the map. At each grid_point the robot will search around him. All
gird_points together should cover the map.
|
|
1 | 2019-11-23 | asr_gazebo_models |
This package provides our gazebo_models
This package provides our gazebo_models
|
|
1 | 2019-12-14 | asr_ftc_local_planner |
A local planner which based on the "follow the carrot" algorithm. Drives accurate along the global plan
A local planner which based on the "follow the carrot" algorithm. Drives accurate along the global plan
|
|
1 | 2020-02-17 | asr_flock_of_birds_tracking |
This package controls a motorized robot head (a sensor setup equipped with a PTU) in order to ensure that the hand of a human user remains inside its field of view. The human hand is tracked with the help of an Ascension - Flock of Birds system. The purpose of this package is to enable continuous localization of objects during their manipulation through the tracked hand.
This package controls a motorized robot head (a sensor setup equipped with a PTU) in order to ensure that the hand of a human user remains inside its field of view. The human hand is tracked with the help of an Ascension - Flock of Birds system. The purpose of this package is to enable continuous localization of objects during their manipulation through the tracked hand.
|
|
1 | 2017-06-27 | asr_flock_of_birds |
The asr_flock_of_birds package is the driver for Ascension Technology Corp magnet-tracking system "Flock of Birds". It provides the remote server which publishes two 6d posemarker and the nessesary TF from the magnettracking system. It also contains launchfiles and calibration tools for the use of it.
The asr_flock_of_birds package is the driver for Ascension Technology Corp magnet-tracking system "Flock of Birds". It provides the remote server which publishes two 6d posemarker and the nessesary TF from the magnettracking system. It also contains launchfiles and calibration tools for the use of it.
|
|
1 | 2019-11-14 | asr_flir_ptu_driver |
asr_flir_ptu_driver is a package for controlling a flir ptu via (external) msg
authors: Valerij Wittenbeck, Joachim Gehrung, Pascal Meissner, Patrick Schlosser
asr_flir_ptu_driver is a package for controlling a flir ptu via (external) msg
authors: Valerij Wittenbeck, Joachim Gehrung, Pascal Meissner, Patrick Schlosser
|
|
1 | 2019-11-23 | asr_flir_ptu_controller |
asr_flir_ptu_controller is a package to control a flir ptu unit from a action server
asr_flir_ptu_controller is a package to control a flir ptu unit from a action server
|
|
1 | 2020-02-17 | asr_fake_object_recognition |
This package provides a 'perception algorithm'-independent simulation of 6-D object localization for 3D object search by a mobile robot: Based on the poses of the searched objects with respect to the current viewing frustum(s) of the robot, the detectability of the objects is estimated.
This package provides a 'perception algorithm'-independent simulation of 6-D object localization for 3D object search by a mobile robot: Based on the poses of the searched objects with respect to the current viewing frustum(s) of the robot, the detectability of the objects is estimated.
|
|
1 | 2020-01-06 | asr_direct_search_manager |
This package can be used to generate and manage poses for the direct mode of 3-D
object search. The direct mode is used as an opening procedure for Active Scene Recognition.
The poses will be generated so that they cover the current environment map.
There are different modes to generate these poses. One is based on a grid and a
second on a recording of the "cropbox record" mode in the asr_state_machine.
This package can be used to generate and manage poses for the direct mode of 3-D
object search. The direct mode is used as an opening procedure for Active Scene Recognition.
The poses will be generated so that they cover the current environment map.
There are different modes to generate these poses. One is based on a grid and a
second on a recording of the "cropbox record" mode in the asr_state_machine.
|
|
1 | 2019-12-14 | asr_descriptor_surface_based_recognition |
This package contains a 6-DoF object localizer for textured household objects
This package contains a 6-DoF object localizer for textured household objects
|
|
1 | 2017-06-27 | asr_cyberglove_visualization |
This package is used to test the functionalities of the CyberGloves and FlockOfBirds.
It uses an URDF model of a human hand to provide a visualization of the glove movements in RViz.
This package is used to test the functionalities of the CyberGloves and FlockOfBirds.
It uses an URDF model of a human hand to provide a visualization of the glove movements in RViz.
|
|
1 | 2017-06-27 | asr_cyberglove_lib |
This package is used to start a server that provides the current joint state values received from the CyberGloves via ROS topics
This package is used to start a server that provides the current joint state values received from the CyberGloves via ROS topics
|
|
1 | 2017-10-02 | asr_calibration_tool_dome |
This package provides a tool for calibraiting the kinematic chain of the PdB-Dome. It provides a data-tracking for recording 6D positions of Flock of Birds data glove and a checkerboard mounted on it. With this construction, the kinematic chain is closed. The recorded data is written to a file and can be used for the asr_kinematic_chain_optimizer.
This package provides a tool for calibraiting the kinematic chain of the PdB-Dome. It provides a data-tracking for recording 6D positions of Flock of Birds data glove and a checkerboard mounted on it. With this construction, the kinematic chain is closed. The recorded data is written to a file and can be used for the asr_kinematic_chain_optimizer.
|
|
1 | 2017-10-02 | asr_aruco_marker_recognition |
This package contains a marker recognition system using the ArUco library.
It can be used with a mono or stereo camera system but yields better results with the latter.
This package contains a marker recognition system using the ArUco library.
It can be used with a mono or stereo camera system but yields better results with the latter.
|
|
1 | asio_cmake_module | |||
1 | as2_visualization | |||
1 | as2_usb_camera_interface | |||
1 | as2_state_estimator | |||
1 | as2_rviz_plugins | |||
1 | as2_realsense_interface | |||
1 | as2_python_api | |||
1 | as2_platform_tello | |||
1 | as2_platform_pixhawk | |||
1 | as2_platform_multirotor_simulator | |||
1 | as2_platform_mavlink | |||
1 | as2_platform_gazebo | |||
1 | as2_platform_dji_psdk | |||
1 | as2_platform_dji_osdk | |||
1 | as2_platform_crazyflie | |||
1 | as2_msgs | |||
1 | as2_motion_reference_handlers | |||
1 | as2_motion_controller | |||
1 | as2_map_server | |||
1 | as2_keyboard_teleoperation | |||
1 | as2_geozones | |||
1 | as2_gazebo_assets | |||
1 | as2_external_object_to_tf | |||
1 | as2_core | |||
1 | as2_cli | |||
1 | as2_behaviors_trajectory_generation | |||
1 | as2_behaviors_platform | |||
1 | as2_behaviors_perception | |||
1 | as2_behaviors_path_planning | |||
1 | as2_behaviors_motion | |||
1 | as2_behavior_tree | |||
1 | as2_behavior | |||
1 | as2_alphanumeric_viewer | |||
2 | aruco_opencv_msgs | |||
2 | aruco_opencv | |||
1 | arm_sim_scenario | |||
1 | 2024-07-03 | arm |
Composite arm procedure
Composite arm procedure
|
|
1 | apriltag_msgs | |||
1 | apriltag_mit | |||
1 | apriltag_draw | |||
1 | apriltag_detector_umich | |||
1 | apriltag_detector_mit | |||
1 | apriltag_detector | |||
1 | apex_test_tools | |||
1 | apex_containers | |||
1 | andino_slam | |||
1 | andino_navigation | |||
1 | andino_hardware | |||
1 | andino_gz_classic | |||
1 | andino_gz | |||
1 | andino_firmware | |||
1 | andino_description | |||
1 | andino_control | |||
1 | andino_bringup | |||
1 | andino_base | |||
1 | andino_apps | |||
1 | 2021-11-26 | amr_interop_msgs |
The AMR interop_msgs package
The AMR interop_msgs package
|
|
1 | 2021-11-26 | amr_interop_bridge |
The AMR interop_bridge package
The AMR interop_bridge package
|
|
1 | ament_xmllint | |||
1 | ament_vitis | |||
1 | ament_uncrustify | |||
1 | ament_pyflakes | |||
1 | ament_pycodestyle | |||
1 | ament_pep257 | |||
1 | ament_pclint | |||
1 | ament_package | |||
1 | ament_nodl | |||
1 | ament_mypy | |||
1 | ament_lint_common | |||
1 | ament_lint_cmake | |||
1 | ament_lint_auto | |||
1 | ament_lint | |||
1 | ament_index_python | |||
1 | ament_index_cpp | |||
1 | ament_flake8 | |||
1 | ament_download | |||
1 | ament_cpplint | |||
1 | ament_cppcheck | |||
1 | ament_copyright | |||
1 | ament_cmake_xmllint | |||
1 | ament_cmake_version | |||
1 | ament_cmake_vendor_package | |||
1 | ament_cmake_uncrustify | |||
1 | ament_cmake_test | |||
1 | ament_cmake_target_dependencies | |||
1 | ament_cmake_ros | |||
1 | ament_cmake_python | |||
1 | ament_cmake_pytest | |||
1 | ament_cmake_pyflakes | |||
1 | ament_cmake_pycodestyle | |||
1 | ament_cmake_pep257 | |||
1 | ament_cmake_pclint | |||
1 | ament_cmake_nose | |||
1 | ament_cmake_mypy | |||
1 | ament_cmake_lint_cmake | |||
1 | ament_cmake_libraries | |||
1 | ament_cmake_include_directories | |||
1 | ament_cmake_gtest | |||
1 | ament_cmake_google_benchmark | |||
1 | ament_cmake_gmock | |||
1 | ament_cmake_gen_version_h | |||
1 | ament_cmake_flake8 | |||
1 | ament_cmake_export_targets | |||
1 | ament_cmake_export_link_flags | |||
1 | ament_cmake_export_libraries | |||
1 | ament_cmake_export_interfaces | |||
1 | ament_cmake_export_include_directories | |||
1 | ament_cmake_export_dependencies | |||
1 | ament_cmake_export_definitions | |||
1 | ament_cmake_cpplint | |||
1 | ament_cmake_cppcheck | |||
1 | ament_cmake_core | |||
1 | ament_cmake_copyright | |||
1 | ament_cmake_clang_tidy | |||
1 | ament_cmake_clang_format | |||
1 | ament_cmake_catch2 | |||
2 | ament_cmake_black | |||
1 | ament_cmake_auto | |||
1 | ament_cmake | |||
1 | ament_clang_tidy | |||
1 | ament_clang_format | |||
2 | ament_black | |||
1 | ament_acceleration | |||
1 | ai_prompt_msgs | |||
1 | affordance_primitives | |||
1 | aerostack2 | |||
1 | admittance_controller | |||
2 | adi_tmcl | |||
1 | adi_tmc_coe | |||
1 | adi_3dtof_image_stitching | |||
1 | adaptive_component | |||
1 | actuator_msgs | |||
1 | actionlib_tools | |||
1 | action_tutorials_py | |||
1 | action_tutorials_interfaces | |||
1 | action_tutorials_cpp | |||
1 | action_msgs | |||
1 | 2024-07-03 | access_control |
The acceess control package provides the ability to reject commands sent by an operator that doesn't have control
The acceess control package provides the ability to reject commands sent by an operator that doesn't have control
|
|
1 | acado_vendor | |||
1 | aandd_ekew_driver_py | |||
0 | SDL | |||
0 | OpenCV | |||
0 | Eigen3 | |||
0 | Eigen | |||
0 | Boost | |||
1 |