Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | 2019-03-29 | depthimage_to_laserscan |
depthimage_to_laserscan
depthimage_to_laserscan
|
||
| 1 | 2019-03-27 | rmw_fastrtps_shared_cpp |
Code shared on static and dynamic type support of rmw_fastrtps_cpp.
Code shared on static and dynamic type support of rmw_fastrtps_cpp.
|
||
| 1 | 2019-03-27 | rmw_fastrtps_dynamic_cpp |
Implement the ROS middleware interface using eProsima FastRTPS static code generation in C++.
Implement the ROS middleware interface using eProsima FastRTPS static code generation in C++.
|
||
| 1 | 2019-03-27 | rmw_fastrtps_cpp |
Implement the ROS middleware interface using eProsima FastRTPS static code generation in C++.
Implement the ROS middleware interface using eProsima FastRTPS static code generation in C++.
|
||
| 1 | 2019-03-20 | ros_environment |
The package provides the environment variables `ROS_VERSION` and `ROS_DISTRO`.
The package provides the environment variables `ROS_VERSION` and `ROS_DISTRO`.
|
||
| 1 | 2019-03-18 | system_modes_examples |
Simple example system for system_modes package.
Simple example system for system_modes package.
|
||
| 1 | 2019-03-18 | system_modes |
Model-based distributed configuration handling.
Model-based distributed configuration handling.
|
||
| 1 | 2019-03-15 | diagnostic_updater |
diagnostic_updater contains tools for easily updating diagnostics. it is commonly used in device drivers to keep track of the status of output topics, device status, etc.
diagnostic_updater contains tools for easily updating diagnostics. it is commonly used in device drivers to keep track of the status of output topics, device status, etc.
|
||
| 1 | 2019-03-13 | navigation2 |
ROS2 Navigation Stack
ROS2 Navigation Stack
|
||
| 2 | 2019-03-13 | nav_2d_utils |
A handful of useful utility functions for nav_2d packages.
A handful of useful utility functions for nav_2d packages.
|
||
| 2 | 2019-03-13 | nav_2d_msgs |
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
|
||
| 1 | 2019-03-13 | nav2_world_model |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_voxel_grid |
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
|
||
| 1 | 2019-03-13 | nav2_util |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_tasks |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_system_tests |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_simple_navigator |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_robot |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_navfn_planner |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_msgs |
Messages and service files for the navigation2 stack
Messages and service files for the navigation2 stack
|
||
| 1 | 2019-03-13 | nav2_motion_primitives |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_mission_executor |
TODO
TODO
|
||
| 1 | 2019-03-13 | nav2_map_server |
Refactored map server for ROS2 Navigation
Refactored map server for ROS2 Navigation
|
||
| 1 | 2019-03-13 | nav2_dynamic_params |
This package provides a validation class for ROS2 parameters with validation based on parameter
type and defined bounds. Support for custom validation callbacks is also provided. Some useful
convenience functions for event callbacks are also provided
This package provides a validation class for ROS2 parameters with validation based on parameter
type and defined bounds. Support for custom validation callbacks is also provided. Some useful
convenience functions for event callbacks are also provided
|
||
| 1 | 2019-03-13 | nav2_dwb_controller |
ROS2 controller (DWB) metapackage
ROS2 controller (DWB) metapackage
|
||
| 1 | 2019-03-13 | nav2_costmap_2d |
This package provides an implementation of a 2D costmap that takes in sensor
data from the world, builds a 2D or 3D occupancy grid of the data (depending
on whether a voxel based implementation is used), and inflates costs in a
2D costmap based on the occupancy grid and a user specified inflation radius.
This package also provides support for map_server based initialization of a
costmap, rolling window based costmaps, and parameter based subscription to
and configuration of sensor topics.
This package provides an implementation of a 2D costmap that takes in sensor
data from the world, builds a 2D or 3D occupancy grid of the data (depending
on whether a voxel based implementation is used), and inflates costs in a
2D costmap based on the occupancy grid and a user specified inflation radius.
This package also provides support for map_server based initialization of a
costmap, rolling window based costmaps, and parameter based subscription to
and configuration of sensor topics.
|
||
| 1 | 2019-03-13 | nav2_common |
Common support functionality used throughout the navigation 2 stack
Common support functionality used throughout the navigation 2 stack
|
||
| 1 | 2019-03-13 | nav2_bt_navigator |
TODO
TODO
|
||
| 2 | 2019-03-13 | nav2_bringup |
Bringup scripts and configurations for the navigation2 stack
Bringup scripts and configurations for the navigation2 stack
|
||
| 1 | 2019-03-13 | nav2_amcl |
|
||
| 2 | 2019-03-13 | dwb_plugins |
Standard implementations of the GoalChecker
and TrajectoryGenerators for dwb_core
Standard implementations of the GoalChecker
and TrajectoryGenerators for dwb_core
|
||
| 2 | 2019-03-13 | dwb_msgs |
Message/Service definitions specifically for the dwb_core
Message/Service definitions specifically for the dwb_core
|
||
| 2 | 2019-03-13 | dwb_critics |
The dwb_critics package
The dwb_critics package
|
||
| 1 | 2019-03-13 | dwb_core |
TODO
TODO
|
||
| 1 | 2019-03-13 | dwb_controller |
TODO
TODO
|
||
| 2 | 2019-03-13 | costmap_queue |
The costmap_queue package
The costmap_queue package
|
||
| 1 | 2019-03-12 | sros2_cmake |
Cmake macros to configure security for nodes
Cmake macros to configure security for nodes
|
||
| 1 | 2019-03-12 | sros2 |
Command line tools for managing SROS2 keys
Command line tools for managing SROS2 keys
|
||
| 1 | 2019-03-09 | test_msgs |
A package containing message definitions and fixtures used exclusively for testing purposes.
A package containing message definitions and fixtures used exclusively for testing purposes.
|
||
| 1 | 2019-03-09 | rosidl_typesupport_cpp |
Generate the type support for C++ messages.
Generate the type support for C++ messages.
|
||
| 1 | 2019-03-09 | rosidl_typesupport_c |
Generate the type support for C messages.
Generate the type support for C messages.
|
||
| 2 | 2019-03-09 | rosidl_generator_py |
Generate the ROS interfaces in Python.
Generate the ROS interfaces in Python.
|
||
| 3 | 2019-03-09 | rosgraph_msgs |
Messages relating to the ROS Computation Graph.
These are generally considered to be low-level messages that end users do not interact with.
Messages relating to the ROS Computation Graph.
These are generally considered to be low-level messages that end users do not interact with.
|
||
| 1 | 2019-03-09 | rcl_logging_noop |
An rcl logger implementation that doesn't do anything with log messages.
An rcl logger implementation that doesn't do anything with log messages.
|
||
| 1 | 2019-03-09 | rcl_logging_log4cxx |
C API providing common interface to a shared library wrapping 3rd party loggers.
C API providing common interface to a shared library wrapping 3rd party loggers.
|
||
| 1 | 2019-03-09 | rcl_interfaces |
The ROS client library common interfaces.
This package contains the messages and services which ROS client libraries will use under the hood to
communicate higher level concepts such as parameters.
The ROS client library common interfaces.
This package contains the messages and services which ROS client libraries will use under the hood to
communicate higher level concepts such as parameters.
|
||
| 2 | 2019-03-09 | python_cmake_module |
Provide CMake module with extra functionality for Python.
Provide CMake module with extra functionality for Python.
|
||
| 1 | 2019-03-09 | lifecycle_msgs |
A package containing some lifecycle related message and service definitions.
A package containing some lifecycle related message and service definitions.
|
||
| 1 | 2019-03-09 | examples_rclpy_minimal_subscriber |
Examples of minimal subscribers using rclpy.
Examples of minimal subscribers using rclpy.
|
||
| 1 | 2019-03-09 | examples_rclpy_minimal_service |
Examples of minimal service servers using rclpy.
Examples of minimal service servers using rclpy.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-08-22 | ros1_bridge |
A simple bridge between ROS 1 and ROS 2
A simple bridge between ROS 1 and ROS 2
|
||
| 1 | 2018-08-22 | rclpy |
Package containing the Python client.
Package containing the Python client.
|
||
| 2 | 2018-08-22 | nav_msgs |
A package containing some navigation related message and service definitions.
A package containing some navigation related message and service definitions.
|
||
| 1 | 2018-08-22 | launch_testing |
Helper scripts for tests that use the ROS launch tool.
Helper scripts for tests that use the ROS launch tool.
|
||
| 1 | 2018-08-22 | launch_ros |
ROS specific extensions to the launch tool.
ROS specific extensions to the launch tool.
|
||
| 1 | 2018-08-22 | launch |
The ROS launch tool.
The ROS launch tool.
|
||
| 2 | 2018-08-22 | geometry_msgs |
A package containing some geometry related message definitions.
A package containing some geometry related message definitions.
|
||
| 2 | 2018-08-22 | diagnostic_msgs |
A package containing some diagnostics related message and service definitions.
A package containing some diagnostics related message and service definitions.
|
||
| 1 | 2018-08-22 | common_interfaces |
common_interfaces contains messages and services that are widely used by other ROS packages.
common_interfaces contains messages and services that are widely used by other ROS packages.
|
||
| 2 | 2018-08-22 | actionlib_msgs |
A package containing some message definitions used in the implementation or actions.
A package containing some message definitions used in the implementation or actions.
|
||
| 1 | 2018-08-20 | rviz_yaml_cpp_vendor |
Wrapper around yaml-cpp, it provides a fixed CMake module and an ExternalProject build of it.
Wrapper around yaml-cpp, it provides a fixed CMake module and an ExternalProject build of it.
|
||
| 1 | 2018-08-20 | rviz_visual_testing_framework |
3D testing framework for RViz.
3D testing framework for RViz.
|
||
| 1 | 2018-08-20 | rviz_rendering_tests |
Example plugin for RViz - documents and tests RViz plugin development
Example plugin for RViz - documents and tests RViz plugin development
|
||
| 1 | 2018-08-20 | rviz_rendering |
Library which provides the 3D rendering functionality in rviz.
Library which provides the 3D rendering functionality in rviz.
|
||
| 1 | 2018-08-20 | rviz_ogre_vendor |
Wrapper around ogre3d, it provides a fixed CMake module and an ExternalProject build of ogre.
Wrapper around ogre3d, it provides a fixed CMake module and an ExternalProject build of ogre.
|
||
| 1 | 2018-08-20 | rviz_default_plugins |
Several default plugins for rviz to cover the basic functionality.
Several default plugins for rviz to cover the basic functionality.
|
||
| 1 | 2018-08-20 | rviz_common |
Common rviz API, used by rviz plugins and applications.
Common rviz API, used by rviz plugins and applications.
|
||
| 1 | 2018-08-20 | rviz_assimp_vendor |
Wrapper around assimp, providing nothing but a dependency on assimp, on some systems.
On others, it provides a fixed CMake module or even an ExternalProject build of assimp.
Wrapper around assimp, providing nothing but a dependency on assimp, on some systems.
On others, it provides a fixed CMake module or even an ExternalProject build of assimp.
|
||
| 1 | 2018-08-20 | rviz2 |
3D visualization tool for ROS.
3D visualization tool for ROS.
|
||
| 1 | 2018-08-20 | ros_environment |
The package provides the environment variables `ROS_VERSION` and `ROS_DISTRO`.
The package provides the environment variables `ROS_VERSION` and `ROS_DISTRO`.
|
||
| 1 | 2018-07-20 | turtlebot2_teleop |
Launch files for turtlebot2 teleop demo
Launch files for turtlebot2 teleop demo
|
||
| 1 | 2018-07-20 | turtlebot2_follower |
A simple follower using centroid in depth images.
A simple follower using centroid in depth images.
|
||
| 1 | 2018-07-20 | turtlebot2_drivers |
Set of drivers to talk to the kobuki base.
Set of drivers to talk to the kobuki base.
|
||
| 1 | 2018-07-20 | turtlebot2_demo |
Metapackage aggregating the turtlebot2 demo packages
Metapackage aggregating the turtlebot2 demo packages
|
||
| 1 | 2018-07-20 | turtlebot2_cartographer |
Launch files for turtlebot2 cartographer demo
Launch files for turtlebot2 cartographer demo
|
||
| 1 | 2018-07-20 | turtlebot2_amcl |
Demo of turtlebot2 localization with amcl.
Demo of turtlebot2 localization with amcl.
|
||
| 1 | 2018-07-20 | depthimage_to_pointcloud2 |
A simple node to convert a depth image and camera info into a PointCloud2.
A simple node to convert a depth image and camera info into a PointCloud2.
|
||
| 1 | 2018-07-19 | ament_package |
The parser for the manifest files in the ament buildsystem.
The parser for the manifest files in the ament buildsystem.
|
||
| 1 | 2018-07-18 | urg_node |
urg_node
urg_node
|
||
| 2 | 2018-07-18 | ros_core |
A package to aggregate the packages required to use publish / subscribe, services, generate messages and other core ROS concepts.
A package to aggregate the packages required to use publish / subscribe, services, generate messages and other core ROS concepts.
|
||
| 2 | 2018-07-18 | ros_base |
A package which extends 'ros_core' and includes other basic functionalities like tf2 and urdf.
A package which extends 'ros_core' and includes other basic functionalities like tf2 and urdf.
|
||
| 2 | 2018-07-18 | desktop |
A package which extends 'ros_base' and includes high level packages like vizualization tools and demos.
A package which extends 'ros_base' and includes high level packages like vizualization tools and demos.
|
||
| 2 | 2018-07-17 | rosidl_generator_py |
Generate the ROS interfaces in Python.
Generate the ROS interfaces in Python.
|
||
| 1 | 2018-07-17 | rmw_implementation |
The decision which ROS middleware implementation should be used for C++.
The decision which ROS middleware implementation should be used for C++.
|
||
| 1 | 2018-07-17 | rcl_yaml_param_parser |
Package containing various utility types and functions for C
Package containing various utility types and functions for C
|
||
| 1 | 2018-07-17 | rcl_lifecycle |
Package containing a C-based lifecycle implementation
Package containing a C-based lifecycle implementation
|
||
| 1 | 2018-07-17 | rcl |
The ROS client library common implementation.
This package contains an API which builds on the ROS middleware API and is optionally built upon by the other ROS client libraries.
The ROS client library common implementation.
This package contains an API which builds on the ROS middleware API and is optionally built upon by the other ROS client libraries.
|
||
| 2 | 2018-07-17 | python_cmake_module |
Provide CMake module with extra functionality for Python.
Provide CMake module with extra functionality for Python.
|
||
| 1 | 2018-07-17 | ament_cmake_test |
The ability to add tests in the ament buildsystem in CMake.
The ability to add tests in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_target_dependencies |
The ability to add definitions, include directories and libraries of a package to a target in the ament buildsystem in CMake.
The ability to add definitions, include directories and libraries of a package to a target in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_python |
The ability to use Python in the ament buildsystem in CMake.
The ability to use Python in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_pytest |
The ability to run Python tests using pytest in the ament buildsystem in CMake.
The ability to run Python tests using pytest in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_nose |
The ability to add nose-based tests in the ament buildsystem in CMake.
The ability to add nose-based tests in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_libraries |
The functionality to deduplicate libraries in the ament buildsystem in CMake.
The functionality to deduplicate libraries in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_include_directories |
The functionality to order include directories according to a chain of prefixes in the ament buildsystem in CMake.
The functionality to order include directories according to a chain of prefixes in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_gtest |
The ability to add gtest-based tests in the ament buildsystem in CMake.
The ability to add gtest-based tests in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_gmock |
The ability to add Google mock-based tests in the ament buildsystem in CMake.
The ability to add Google mock-based tests in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_export_link_flags |
The ability to export link flags to downstream packages in the ament buildsystem.
The ability to export link flags to downstream packages in the ament buildsystem.
|
||
| 1 | 2018-07-17 | ament_cmake_export_libraries |
The ability to export libraries to downstream packages in the ament buildsystem in CMake.
The ability to export libraries to downstream packages in the ament buildsystem in CMake.
|
||
| 1 | 2018-07-17 | ament_cmake_export_interfaces |
The ability to export interfaces to downstream packages in the ament buildsystem in CMake.
The ability to export interfaces to downstream packages in the ament buildsystem in CMake.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-05-23 | opt_camera |
opt_camera
opt_camera
|
||
| 1 | 2019-05-23 | nlopt |
nlopt
nlopt
|
||
| 1 | 2019-05-23 | neonavigation_msgs |
Message definitions for neonavigation package
Message definitions for neonavigation package
|
||
| 1 | 2019-05-23 | mini_maxwell |
mini_maxwell
mini_maxwell
|
||
| 1 | 2019-05-23 | mcl_3dl_msgs |
The mcl_3dl message definition package
The mcl_3dl message definition package
|
||
| 1 | 2019-05-23 | mcl_3dl |
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
|
||
| 1 | 2019-05-23 | marti_data_structures |
marti_data_structures
marti_data_structures
|
||
| 1 | 2019-05-23 | map_organizer_msgs |
Message definitions for map_organizer_msgs package
Message definitions for map_organizer_msgs package
|
||
| 1 | 2019-05-23 | lpg_planner |
lpg_planner: LPGL Planner (http://zeus.ing.unibs.it/lpg/)
lpg_planner: LPGL Planner (http://zeus.ing.unibs.it/lpg/)
|
||
| 1 | 2019-05-23 | libsiftfast |
Library to compute SIFT features
Library to compute SIFT features
|
||
| 1 | 2019-05-23 | libcmt |
libCMT ROS Wrapper
libCMT ROS Wrapper
|
||
| 1 | 2019-05-23 | laser_filters_jsk_patch |
laser_filters_jsk_patch
laser_filters_jsk_patch
|
||
| 1 | 2019-05-23 | laser_filters |
Assorted filters designed to operate on 2D planar laser scanners,
which use the sensor_msgs/LaserScan type.
Assorted filters designed to operate on 2D planar laser scanners,
which use the sensor_msgs/LaserScan type.
|
||
| 1 | 2019-05-23 | julius_ros |
The julius_ros package
The julius_ros package
|
||
| 1 | 2019-05-23 | julius |
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
|
||
| 1 | 2019-05-23 | jsk_3rdparty |
|
||
| 1 | 2019-05-23 | ffha |
ffha: PDDL Planner (http://ipc.informatik.uni-freiburg.de)
ffha: PDDL Planner (http://ipc.informatik.uni-freiburg.de)
|
||
| 1 | 2019-05-23 | ff |
ff: pddl planner. see http://www.loria.fr/~hoffmanj/ff.html
ff: pddl planner. see http://www.loria.fr/~hoffmanj/ff.html
|
||
| 1 | 2019-05-23 | fanuc_post_processor |
Fanuc post-processor
Fanuc post-processor
|
||
| 1 | 2019-05-23 | exotica_time_indexed_rrt_connect_solver |
Time-Indexed RRT-Connect solver (Humanoids 2018)
Time-Indexed RRT-Connect solver (Humanoids 2018)
|
||
| 1 | 2019-05-23 | exotica_scipy_solver |
SciPy-based Python solvers for Exotica
SciPy-based Python solvers for Exotica
|
||
| 1 | 2019-05-23 | exotica_quadrotor_dynamics_solver |
Quadrotor dynamics solver plug-in for Exotica
Quadrotor dynamics solver plug-in for Exotica
|
||
| 1 | 2019-05-23 | exotica_python |
Python bindings for EXOTica
Python bindings for EXOTica
|
||
| 1 | 2019-05-23 | exotica_pinocchio_dynamics_solver |
Dynamics solver plug-in using Pinocchio for Exotica
Dynamics solver plug-in using Pinocchio for Exotica
|
||
| 1 | 2019-05-23 | exotica_ompl_solver |
Exotica solvers based on the Open Motion Planning Libary (OMPL)
Exotica solvers based on the Open Motion Planning Libary (OMPL)
|
||
| 1 | 2019-05-23 | exotica_levenberg_marquardt_solver |
A Levenberg-Marquardt solver for EXOTica
A Levenberg-Marquardt solver for EXOTica
|
||
| 1 | 2019-05-23 | exotica_ik_solver |
Pseudo-inverse unconstrained end-pose solver
Pseudo-inverse unconstrained end-pose solver
|
||
| 1 | 2019-05-23 | exotica_examples |
Package containing examples and system tests for EXOTica.
Package containing examples and system tests for EXOTica.
|
||
| 1 | 2019-05-23 | exotica_double_integrator_dynamics_solver |
Double integrator dynamics solver plug-in for Exotica
Double integrator dynamics solver plug-in for Exotica
|
||
| 1 | 2019-05-23 | exotica_core_task_maps |
Common taskmaps provided with EXOTica.
Common taskmaps provided with EXOTica.
|
||
| 1 | 2019-05-23 | exotica_core |
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning.
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning.
|
||
| 1 | 2019-05-23 | exotica_collision_scene_fcl_latest |
Collision checking and distance computation using the latest version of the FCL library.
Collision checking and distance computation using the latest version of the FCL library.
|
||
| 1 | 2019-05-23 | exotica_collision_scene_fcl |
Collision checking using the FCL library.
Collision checking using the FCL library.
|
||
| 1 | 2019-05-23 | exotica_aico_solver |
Implementation of the Approximate Inference Control algorithm (AICO)
Implementation of the Approximate Inference Control algorithm (AICO)
|
||
| 1 | 2019-05-23 | exotica |
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning. This package serves similar to a metapackage and contains dependencies onto all core-released exotica packages. It also builds the documentation.
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning. This package serves similar to a metapackage and contains dependencies onto all core-released exotica packages. It also builds the documentation.
|
||
| 1 | 2019-05-23 | downward |
fast downward: PDDL Planner (http://www.fast-downward.org)
fast downward: PDDL Planner (http://www.fast-downward.org)
|
||
| 1 | 2019-05-23 | costmap_cspace_msgs |
Message definitions for costmap_cspace package
Message definitions for costmap_cspace package
|
||
| 1 | 2019-05-23 | collada_urdf_jsk_patch |
unaccepted patch for collada_urdf
unaccepted patch for collada_urdf
|
||
| 1 | 2019-05-23 | catkin |
Low-level build system macros and infrastructure for ROS.
Low-level build system macros and infrastructure for ROS.
|
||
| 1 | 2019-05-23 | bayesian_belief_networks |
The bayesian_belief_networks package form https://github.com/eBay/bayesian-belief-networks, Authored by Neville Newey, Anzar Afaq, Copyright 2013 eBay Software Foundation
The bayesian_belief_networks package form https://github.com/eBay/bayesian-belief-networks, Authored by Neville Newey, Anzar Afaq, Copyright 2013 eBay Software Foundation
|
||
| 1 | 2019-05-23 | assimp_devel |
assimp library
assimp library
|
||
| 1 | 2019-05-22 | virtual_force_publisher |
publish end effector's force, which is estmated from joint torque value
publish end effector's force, which is estmated from joint torque value
|
||
| 1 | 2019-05-22 | urg_stamped |
Precisely stamped URG driver for ROS
Precisely stamped URG driver for ROS
|
||
| 1 | 2019-05-22 | toposens_pointcloud |
PCL integration for TS sensors mounted on Turtlebot3.
PCL integration for TS sensors mounted on Turtlebot3.
|
||
| 1 | 2019-05-22 | toposens_msgs |
ROS message definitions for TS sensors.
ROS message definitions for TS sensors.
|
||
| 1 | 2019-05-22 | toposens_markers |
Rviz integration for TS sensor data.
Rviz integration for TS sensor data.
|
||
| 1 | 2019-05-22 | toposens_driver |
ROS device driver for communication with TS sensors.
ROS device driver for communication with TS sensors.
|
||
| 1 | 2019-05-22 | toposens_description |
3D models of the sensor for visualization.
3D models of the sensor for visualization.
|
||
| 1 | 2019-05-22 | toposens |
ROS support for Toposens 3D Ultrasound sensors.
ROS support for Toposens 3D Ultrasound sensors.
|
||
| 1 | 2019-05-22 | test_mavros |
Tests for MAVROS package
Tests for MAVROS package
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-05-23 | downward |
fast downward: PDDL Planner (http://www.fast-downward.org)
fast downward: PDDL Planner (http://www.fast-downward.org)
|
||
| 1 | 2019-05-23 | costmap_cspace_msgs |
Message definitions for costmap_cspace package
Message definitions for costmap_cspace package
|
||
| 1 | 2019-05-23 | collada_urdf_jsk_patch |
unaccepted patch for collada_urdf
unaccepted patch for collada_urdf
|
||
| 1 | 2019-05-23 | catkin |
Low-level build system macros and infrastructure for ROS.
Low-level build system macros and infrastructure for ROS.
|
||
| 1 | 2019-05-23 | bayesian_belief_networks |
The bayesian_belief_networks package form https://github.com/eBay/bayesian-belief-networks, Authored by Neville Newey, Anzar Afaq, Copyright 2013 eBay Software Foundation
The bayesian_belief_networks package form https://github.com/eBay/bayesian-belief-networks, Authored by Neville Newey, Anzar Afaq, Copyright 2013 eBay Software Foundation
|
||
| 1 | 2019-05-23 | assimp_devel |
assimp library
assimp library
|
||
| 1 | 2019-05-22 | urg_stamped |
Precisely stamped URG driver for ROS
Precisely stamped URG driver for ROS
|
||
| 1 | 2019-05-22 | test_mavros |
Tests for MAVROS package
Tests for MAVROS package
|
||
| 1 | 2019-05-22 | novatel_gps_msgs |
Messages for proprietary (non-NMEA) sentences from Novatel GPS receivers.
Messages for proprietary (non-NMEA) sentences from Novatel GPS receivers.
|
||
| 1 | 2019-05-22 | novatel_gps_driver |
Driver for NovAtel receivers
Driver for NovAtel receivers
|
||
| 1 | 2019-05-22 | mavros_msgs |
mavros_msgs defines messages for
mavros_msgs defines messages for
|
||
| 1 | 2019-05-22 | mavros_extras |
Extra nodes and plugins for
Extra nodes and plugins for
|
||
| 1 | 2019-05-22 | mavros |
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
|
||
| 1 | 2019-05-22 | libmavconn |
MAVLink communication library.
This library provide unified connection handling classes
and URL to connection object mapper.
This library can be used in standalone programs.
MAVLink communication library.
This library provide unified connection handling classes
and URL to connection object mapper.
This library can be used in standalone programs.
|
||
| 1 | 2019-05-21 | ypspur_ros |
ROS wrapper for the mobile robot control platform YP-Spur
ROS wrapper for the mobile robot control platform YP-Spur
|
||
| 1 | 2019-05-21 | velodyne_pointcloud |
Point cloud conversions for Velodyne 3D LIDARs.
Point cloud conversions for Velodyne 3D LIDARs.
|
||
| 1 | 2019-05-21 | velodyne_msgs |
ROS message definitions for Velodyne 3D LIDARs.
ROS message definitions for Velodyne 3D LIDARs.
|
||
| 1 | 2019-05-21 | velodyne_laserscan |
Extract a single ring of a Velodyne PointCloud2 and publish it as a LaserScan message
Extract a single ring of a Velodyne PointCloud2 and publish it as a LaserScan message
|
||
| 1 | 2019-05-21 | velodyne_driver |
ROS device driver for Velodyne 3D LIDARs.
ROS device driver for Velodyne 3D LIDARs.
|
||
| 1 | 2019-05-21 | velodyne |
Basic ROS support for the Velodyne 3D LIDARs.
Basic ROS support for the Velodyne 3D LIDARs.
|
||
| 1 | 2019-05-21 | rtt |
Orocos/RTT component framework
Orocos/RTT component framework
|
||
| 1 | 2019-05-21 | roslisp_utilities |
Some utility functionality to interact with ROS using roslisp.
Some utility functionality to interact with ROS using roslisp.
|
||
| 1 | 2019-05-21 | roslisp_common |
Common libraries to control ROS based robots. This stack contains
an implementation of actionlib (client and server) in Common Lisp,
a transformation library and an implementation of tf in Common
Lisp.
Common libraries to control ROS based robots. This stack contains
an implementation of actionlib (client and server) in Common Lisp,
a transformation library and an implementation of tf in Common
Lisp.
|
||
| 1 | 2019-05-21 | cl_utils |
Common Lisp utility libraries
Common Lisp utility libraries
|
||
| 1 | 2019-05-21 | cl_urdf |
cl_urdf
cl_urdf
|
||
| 1 | 2019-05-21 | cl_transforms_stamped |
Implementation of TF datatypes
Implementation of TF datatypes
|
||
| 1 | 2019-05-21 | cl_transforms |
Homogeneous transform library for Common Lisp.
Homogeneous transform library for Common Lisp.
|
||
| 1 | 2019-05-21 | cl_tf2 |
Client implementation to use TF2 from Common Lisp
Client implementation to use TF2 from Common Lisp
|
||
| 1 | 2019-05-21 | cl_tf |
Client implementation to use TF from Common Lisp
Client implementation to use TF from Common Lisp
|
||
| 1 | 2019-05-21 | actionlib_lisp |
actionlib_lisp is a native implementation of the famous actionlib
in Common Lisp. It provides a client and a simple server.
actionlib_lisp is a native implementation of the famous actionlib
in Common Lisp. It provides a client and a simple server.
|
||
| 1 | 2019-05-20 | rc_visard_driver |
The rc_visard_driver provides data from a Roboception rc_visard 3D sensor on several ROS topics.
The rc_visard_driver provides data from a Roboception rc_visard 3D sensor on several ROS topics.
|
||
| 1 | 2019-05-20 | rc_visard_description |
Visualization package for rc_visard
Visualization package for rc_visard
|
||
| 1 | 2019-05-20 | rc_visard |
Roboception rc_visard support meta package
Roboception rc_visard support meta package
|
||
| 1 | 2019-05-20 | rc_tagdetect_client |
The ros client for roboception tag detection modules
The ros client for roboception tag detection modules
|
||
| 1 | 2019-05-20 | rc_pick_client |
The ros client for roboception grasp generation modules
The ros client for roboception grasp generation modules
|
||
| 1 | 2019-05-20 | rc_hand_eye_calibration_client |
The rc_hand_eye_calibration_client package
The rc_hand_eye_calibration_client package
|
||
| 1 | 2019-05-20 | rc_genicam_api |
GenICam/GigE Vision Convenience Layer.
This package combines the Roboception convenience layer for images with the
GenICam reference implementation and a GigE Vision transport layer. It is a
self contained package that permits configuration and image streaming of
GenICam / GigE Vision 2.0 compatible cameras like the Roboception rc_visard.
This package also provides some tools that can be called from the command line
for discovering cameras, changing their configuration and streaming images.
Although the tools are meant to be useful when working in a shell or in a
script, their main purpose is to serve as example on how to use the API for
reading and setting parameters, streaming and synchronizing images.
See LICENSE.md for licensing terms of the different parts.
GenICam/GigE Vision Convenience Layer.
This package combines the Roboception convenience layer for images with the
GenICam reference implementation and a GigE Vision transport layer. It is a
self contained package that permits configuration and image streaming of
GenICam / GigE Vision 2.0 compatible cameras like the Roboception rc_visard.
This package also provides some tools that can be called from the command line
for discovering cameras, changing their configuration and streaming images.
Although the tools are meant to be useful when working in a shell or in a
script, their main purpose is to serve as example on how to use the API for
reading and setting parameters, streaming and synchronizing images.
See LICENSE.md for licensing terms of the different parts.
|
||
| 1 | 2019-05-20 | generic_control_toolbox |
Implements libraries useful for developing controllers for robotic manipulators.
Implements libraries useful for developing controllers for robotic manipulators.
|
||
| 1 | 2019-05-19 | plotjuggler |
PlotJuggler: juggle with data
PlotJuggler: juggle with data
|
||
| 1 | 2019-05-17 | pacmod3 |
AutonomouStuff PACMod v3 Driver Package
AutonomouStuff PACMod v3 Driver Package
|
||
| 1 | 2019-05-17 | behaviortree_cpp_v3 |
This package provides the Behavior Trees core library.
This package provides the Behavior Trees core library.
|
||
| 1 | 2019-05-16 | sick_scan |
A ROS driver for the SICK TiM and SICK MRS series of laser scanners.
This package is based on the original sick_tim-repository of Martin Günther et al.
A ROS driver for the SICK TiM and SICK MRS series of laser scanners.
This package is based on the original sick_tim-repository of Martin Günther et al.
|
||
| 2 | 2019-05-16 | sbpl_interface_ros |
sbpl_interface_ros
sbpl_interface_ros
|
||
| 2 | 2019-05-16 | sbpl_interface |
sbpl_interface
sbpl_interface
|
||
| 1 | 2019-05-16 | rtt_geometry |
This metapackage contains tools for integrating the Orocos Kinematics and
Dynamics Library (KDL) with the Orocos Toolchain and Real-Time Toolkit
(RTT).
This metapackage contains tools for integrating the Orocos Kinematics and
Dynamics Library (KDL) with the Orocos Toolchain and Real-Time Toolkit
(RTT).
|
||
| 1 | 2019-05-16 | omronsentech_camera |
omronsentech_camera package contains a basic functionality to access OMRON SENTECH Camera. This package requires installation of SentechSDK.
omronsentech_camera package contains a basic functionality to access OMRON SENTECH Camera. This package requires installation of SentechSDK.
|
||
| 2 | 2019-05-16 | moveit_simple_controller_manager |
A generic, simple controller manager plugin for MoveIt.
A generic, simple controller manager plugin for MoveIt.
|
||
| 2 | 2019-05-16 | moveit_setup_assistant |
Generates a configuration package that makes it easy to use MoveIt!
Generates a configuration package that makes it easy to use MoveIt!
|
||
| 1 | 2019-05-16 | moveit_runtime |
moveit_runtime meta package contains MoveIt! packages that are essential for its runtime (e.g. running MoveIt! on robots).
moveit_runtime meta package contains MoveIt! packages that are essential for its runtime (e.g. running MoveIt! on robots).
|
||
| 2 | 2019-05-16 | moveit_ros_warehouse |
Components of MoveIt! connecting to MongoDB
Components of MoveIt! connecting to MongoDB
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-05-23 | pgm_learner |
Parameter/Structure Estimation and Inference for Bayesian Belief Network
Parameter/Structure Estimation and Inference for Bayesian Belief Network
|
||
| 1 | 2019-05-23 | opt_camera |
opt_camera
opt_camera
|
||
| 1 | 2019-05-23 | nlopt |
nlopt
nlopt
|
||
| 1 | 2019-05-23 | neonavigation_msgs |
Message definitions for neonavigation package
Message definitions for neonavigation package
|
||
| 1 | 2019-05-23 | mini_maxwell |
mini_maxwell
mini_maxwell
|
||
| 1 | 2019-05-23 | mcl_3dl_msgs |
The mcl_3dl message definition package
The mcl_3dl message definition package
|
||
| 1 | 2019-05-23 | mcl_3dl |
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
|
||
| 1 | 2019-05-23 | marti_data_structures |
marti_data_structures
marti_data_structures
|
||
| 1 | 2019-05-23 | map_organizer_msgs |
Message definitions for map_organizer_msgs package
Message definitions for map_organizer_msgs package
|
||
| 1 | 2019-05-23 | lpg_planner |
lpg_planner: LPGL Planner (http://zeus.ing.unibs.it/lpg/)
lpg_planner: LPGL Planner (http://zeus.ing.unibs.it/lpg/)
|
||
| 1 | 2019-05-23 | libsiftfast |
Library to compute SIFT features
Library to compute SIFT features
|
||
| 1 | 2019-05-23 | libcmt |
libCMT ROS Wrapper
libCMT ROS Wrapper
|
||
| 1 | 2019-05-23 | laser_filters_jsk_patch |
laser_filters_jsk_patch
laser_filters_jsk_patch
|
||
| 1 | 2019-05-23 | laser_filters |
Assorted filters designed to operate on 2D planar laser scanners,
which use the sensor_msgs/LaserScan type.
Assorted filters designed to operate on 2D planar laser scanners,
which use the sensor_msgs/LaserScan type.
|
||
| 1 | 2019-05-23 | julius_ros |
The julius_ros package
The julius_ros package
|
||
| 1 | 2019-05-23 | julius |
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
|
||
| 1 | 2019-05-23 | jsk_3rdparty |
|
||
| 1 | 2019-05-23 | industrial_robot_status_interface |
Exposes ROS-Industrial's RobotStatus info from hardware_interfaces for consumption by ros_control controllers.
Exposes ROS-Industrial's RobotStatus info from hardware_interfaces for consumption by ros_control controllers.
|
||
| 1 | 2019-05-23 | industrial_robot_status_controller |
A ros_control controller that reports robot status using the ROS-Industrial RobotStatus message.
A ros_control controller that reports robot status using the ROS-Industrial RobotStatus message.
|
||
| 1 | 2019-05-23 | ffha |
ffha: PDDL Planner (http://ipc.informatik.uni-freiburg.de)
ffha: PDDL Planner (http://ipc.informatik.uni-freiburg.de)
|
||
| 1 | 2019-05-23 | ff |
ff: pddl planner. see http://www.loria.fr/~hoffmanj/ff.html
ff: pddl planner. see http://www.loria.fr/~hoffmanj/ff.html
|
||
| 1 | 2019-05-23 | exotica_time_indexed_rrt_connect_solver |
Time-Indexed RRT-Connect solver (Humanoids 2018)
Time-Indexed RRT-Connect solver (Humanoids 2018)
|
||
| 1 | 2019-05-23 | exotica_scipy_solver |
SciPy-based Python solvers for Exotica
SciPy-based Python solvers for Exotica
|
||
| 1 | 2019-05-23 | exotica_quadrotor_dynamics_solver |
Quadrotor dynamics solver plug-in for Exotica
Quadrotor dynamics solver plug-in for Exotica
|
||
| 1 | 2019-05-23 | exotica_python |
Python bindings for EXOTica
Python bindings for EXOTica
|
||
| 1 | 2019-05-23 | exotica_pinocchio_dynamics_solver |
Dynamics solver plug-in using Pinocchio for Exotica
Dynamics solver plug-in using Pinocchio for Exotica
|
||
| 1 | 2019-05-23 | exotica_ompl_solver |
Exotica solvers based on the Open Motion Planning Libary (OMPL)
Exotica solvers based on the Open Motion Planning Libary (OMPL)
|
||
| 1 | 2019-05-23 | exotica_levenberg_marquardt_solver |
A Levenberg-Marquardt solver for EXOTica
A Levenberg-Marquardt solver for EXOTica
|
||
| 1 | 2019-05-23 | exotica_ik_solver |
Pseudo-inverse unconstrained end-pose solver
Pseudo-inverse unconstrained end-pose solver
|
||
| 1 | 2019-05-23 | exotica_examples |
Package containing examples and system tests for EXOTica.
Package containing examples and system tests for EXOTica.
|
||
| 1 | 2019-05-23 | exotica_double_integrator_dynamics_solver |
Double integrator dynamics solver plug-in for Exotica
Double integrator dynamics solver plug-in for Exotica
|
||
| 1 | 2019-05-23 | exotica_core_task_maps |
Common taskmaps provided with EXOTica.
Common taskmaps provided with EXOTica.
|
||
| 1 | 2019-05-23 | exotica_core |
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning.
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning.
|
||
| 1 | 2019-05-23 | exotica_collision_scene_fcl_latest |
Collision checking and distance computation using the latest version of the FCL library.
Collision checking and distance computation using the latest version of the FCL library.
|
||
| 1 | 2019-05-23 | exotica_collision_scene_fcl |
Collision checking using the FCL library.
Collision checking using the FCL library.
|
||
| 1 | 2019-05-23 | exotica_aico_solver |
Implementation of the Approximate Inference Control algorithm (AICO)
Implementation of the Approximate Inference Control algorithm (AICO)
|
||
| 1 | 2019-05-23 | exotica |
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning. This package serves similar to a metapackage and contains dependencies onto all core-released exotica packages. It also builds the documentation.
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning. This package serves similar to a metapackage and contains dependencies onto all core-released exotica packages. It also builds the documentation.
|
||
| 1 | 2019-05-23 | downward |
fast downward: PDDL Planner (http://www.fast-downward.org)
fast downward: PDDL Planner (http://www.fast-downward.org)
|
||
| 1 | 2019-05-23 | costmap_cspace_msgs |
Message definitions for costmap_cspace package
Message definitions for costmap_cspace package
|
||
| 1 | 2019-05-23 | collada_urdf_jsk_patch |
unaccepted patch for collada_urdf
unaccepted patch for collada_urdf
|
||
| 1 | 2019-05-23 | catkin |
Low-level build system macros and infrastructure for ROS.
Low-level build system macros and infrastructure for ROS.
|
||
| 1 | 2019-05-23 | bayesian_belief_networks |
The bayesian_belief_networks package form https://github.com/eBay/bayesian-belief-networks, Authored by Neville Newey, Anzar Afaq, Copyright 2013 eBay Software Foundation
The bayesian_belief_networks package form https://github.com/eBay/bayesian-belief-networks, Authored by Neville Newey, Anzar Afaq, Copyright 2013 eBay Software Foundation
|
||
| 1 | 2019-05-23 | assimp_devel |
assimp library
assimp library
|
||
| 1 | 2019-05-22 | virtual_force_publisher |
publish end effector's force, which is estmated from joint torque value
publish end effector's force, which is estmated from joint torque value
|
||
| 1 | 2019-05-22 | urg_stamped |
Precisely stamped URG driver for ROS
Precisely stamped URG driver for ROS
|
||
| 1 | 2019-05-22 | ur_msgs |
The ur_msgs package
The ur_msgs package
|
||
| 1 | 2019-05-22 | ur_kinematics |
Provides forward and inverse kinematics for Universal Robots designs.
See http://hdl.handle.net/1853/50782 for details.
Provides forward and inverse kinematics for Universal Robots designs.
See http://hdl.handle.net/1853/50782 for details.
|
||
| 1 | 2019-05-22 | ur_gazebo |
Gazebo wrapper for the Universal UR5/10 robot arms.
Gazebo wrapper for the Universal UR5/10 robot arms.
|
||
| 1 | 2019-05-22 | ur_e_gazebo |
Gazebo wrapper for the Universal UR5/10 robot arms.
Gazebo wrapper for the Universal UR5/10 robot arms.
|
||
| 1 | 2019-05-22 | ur_e_description |
URDF description for Universal UR5/10 robot arms
URDF description for Universal UR5/10 robot arms
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-05-23 | collada_urdf_jsk_patch |
unaccepted patch for collada_urdf
unaccepted patch for collada_urdf
|
||
| 1 | 2019-05-23 | bayesian_belief_networks |
The bayesian_belief_networks package form https://github.com/eBay/bayesian-belief-networks, Authored by Neville Newey, Anzar Afaq, Copyright 2013 eBay Software Foundation
The bayesian_belief_networks package form https://github.com/eBay/bayesian-belief-networks, Authored by Neville Newey, Anzar Afaq, Copyright 2013 eBay Software Foundation
|
||
| 1 | 2019-05-23 | baxtereus |
The baxtereus package
The baxtereus package
|
||
| 1 | 2019-05-23 | assimp_devel |
assimp library
assimp library
|
||
| 1 | 2019-05-23 | aeroeus |
The aeroeus package
The aeroeus package
|
||
| 1 | 2019-05-22 | virtual_force_publisher |
publish end effector's force, which is estmated from joint torque value
publish end effector's force, which is estmated from joint torque value
|
||
| 1 | 2019-05-22 | urg_stamped |
Precisely stamped URG driver for ROS
Precisely stamped URG driver for ROS
|
||
| 1 | 2019-05-22 | novatel_gps_msgs |
Messages for proprietary (non-NMEA) sentences from Novatel GPS receivers.
Messages for proprietary (non-NMEA) sentences from Novatel GPS receivers.
|
||
| 1 | 2019-05-22 | novatel_gps_driver |
Driver for NovAtel receivers
Driver for NovAtel receivers
|
||
| 1 | 2019-05-22 | multi_map_server |
multi_map_server provides the
multi_map_server provides the
|
||
| 1 | 2019-05-22 | microstrain_3dm |
The microstrain_3dm package provides a driver for the LORD/Microstrain 3DM_GX5_XX GPS-aided IMU sensor.
The microstrain_3dm package provides a driver for the LORD/Microstrain 3DM_GX5_XX GPS-aided IMU sensor.
|
||
| 1 | 2019-05-22 | magni_viz |
The magni_viz package
The magni_viz package
|
||
| 1 | 2019-05-22 | magni_teleop |
The magni_teleop package
The magni_teleop package
|
||
| 1 | 2019-05-22 | magni_robot |
The magni_robot package
The magni_robot package
|
||
| 1 | 2019-05-22 | magni_nav |
The magni_nav package
The magni_nav package
|
||
| 1 | 2019-05-22 | magni_gazebo |
The magni_gazebo package
The magni_gazebo package
|
||
| 1 | 2019-05-22 | magni_desktop |
Meta package for all the desktop side utilities for magni
Meta package for all the desktop side utilities for magni
|
||
| 1 | 2019-05-22 | magni_description |
The magni_description package
The magni_description package
|
||
| 1 | 2019-05-22 | magni_demos |
The magni_demos package
The magni_demos package
|
||
| 1 | 2019-05-22 | magni_bringup |
The magni_bringup package
The magni_bringup package
|
||
| 1 | 2019-05-22 | jsk_topic_tools |
jsk_topic_tools
jsk_topic_tools
|
||
| 1 | 2019-05-22 | jsk_tools |
Includes emacs scripts, ros tool alias generator, and launch doc generator.
Includes emacs scripts, ros tool alias generator, and launch doc generator.
|
||
| 1 | 2019-05-22 | jsk_tilt_laser |
The jsk_tilt_laser package
The jsk_tilt_laser package
|
||
| 1 | 2019-05-22 | jsk_network_tools |
jsk_network_tools
jsk_network_tools
|
||
| 1 | 2019-05-22 | jsk_data |
The jsk_data package
The jsk_data package
|
||
| 1 | 2019-05-22 | jsk_common |
|
||
| 1 | 2019-05-22 | industrial_ci |
This package contains CI (Continuous Integration) configuration that any ROS-powered packages can commonly use. Some notable feature:
This package contains CI (Continuous Integration) configuration that any ROS-powered packages can commonly use. Some notable feature:
|
||
| 1 | 2019-05-22 | image_view2 |
A simple viewer for ROS image topics with draw-on features
A simple viewer for ROS image topics with draw-on features
|
||
| 1 | 2019-05-22 | dynamic_tf_publisher |
dynamically set the tf trensformation
dynamically set the tf trensformation
|
||
| 1 | 2019-05-22 | dbw_mkz_twist_controller |
Twist (speed and angular rate) controller for brake/throttle/steering
Twist (speed and angular rate) controller for brake/throttle/steering
|
||
| 1 | 2019-05-22 | dbw_mkz_msgs |
Drive-by-wire messages for the Lincoln MKZ
Drive-by-wire messages for the Lincoln MKZ
|
||
| 1 | 2019-05-22 | dbw_mkz_joystick_demo |
Demonstration of drive-by-wire with joystick
Demonstration of drive-by-wire with joystick
|
||
| 1 | 2019-05-22 | dbw_mkz_description |
URDF and meshes describing the Lincoln MKZ.
URDF and meshes describing the Lincoln MKZ.
|
||
| 1 | 2019-05-22 | dbw_mkz_can |
Drive-by-wire interface to the Dataspeed Inc. Lincoln MKZ DBW kit
Drive-by-wire interface to the Dataspeed Inc. Lincoln MKZ DBW kit
|
||
| 1 | 2019-05-22 | dbw_mkz |
Drive-by-wire interface to the Dataspeed Inc. Lincoln MKZ DBW kit
Drive-by-wire interface to the Dataspeed Inc. Lincoln MKZ DBW kit
|
||
| 1 | 2019-05-22 | dataspeed_can_usb |
Driver to interface with the Dataspeed Inc. USB CAN Tool
Driver to interface with the Dataspeed Inc. USB CAN Tool
|
||
| 1 | 2019-05-22 | dataspeed_can_tools |
CAN bus introspection
CAN bus introspection
|
||
| 1 | 2019-05-22 | dataspeed_can_msg_filters |
Time synchronize multiple CAN messages to get a single callback
Time synchronize multiple CAN messages to get a single callback
|
||
| 1 | 2019-05-22 | dataspeed_can |
CAN bus tools using Dataspeed hardware
CAN bus tools using Dataspeed hardware
|
||
| 1 | 2019-05-22 | crazyflie_driver |
ROS driver for Crazyflie Nano Quadcopter from Bitcraze
ROS driver for Crazyflie Nano Quadcopter from Bitcraze
|
||
| 1 | 2019-05-22 | crazyflie_description |
URDF Model for the Crazyflie Nano Quadcopter from Bitcraze
URDF Model for the Crazyflie Nano Quadcopter from Bitcraze
|
||
| 1 | 2019-05-22 | crazyflie_demo |
Examples on how to use the crazyflie package (teleoperation, rviz integration)
Examples on how to use the crazyflie package (teleoperation, rviz integration)
|
||
| 1 | 2019-05-22 | crazyflie_controller |
Controller to fly a Crazyflie in a space with location feedback (such as motion capture).
Controller to fly a Crazyflie in a space with location feedback (such as motion capture).
|
||
| 1 | 2019-05-22 | crazyflie |
ROS integration for Crazyflie Nano Quadcopter from Bitcraze
ROS integration for Crazyflie Nano Quadcopter from Bitcraze
|
||
| 1 | 2019-05-21 | ypspur_ros |
ROS wrapper for the mobile robot control platform YP-Spur
ROS wrapper for the mobile robot control platform YP-Spur
|
||
| 1 | 2019-05-21 | velodyne_pointcloud |
Point cloud conversions for Velodyne 3D LIDARs.
Point cloud conversions for Velodyne 3D LIDARs.
|
||
| 1 | 2019-05-21 | velodyne_msgs |
ROS message definitions for Velodyne 3D LIDARs.
ROS message definitions for Velodyne 3D LIDARs.
|
||
| 1 | 2019-05-21 | velodyne_laserscan |
Extract a single ring of a Velodyne PointCloud2 and publish it as a LaserScan message
Extract a single ring of a Velodyne PointCloud2 and publish it as a LaserScan message
|
||
| 1 | 2019-05-21 | velodyne_driver |
ROS device driver for Velodyne 3D LIDARs.
ROS device driver for Velodyne 3D LIDARs.
|
||
| 1 | 2019-05-21 | velodyne |
Basic ROS support for the Velodyne 3D LIDARs.
Basic ROS support for the Velodyne 3D LIDARs.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | 2017-12-08 | map_server |
map_server provides the
map_server provides the
|
||
| 1 | 2017-12-08 | logging_demo |
Examples for using and configuring loggers.
Examples for using and configuring loggers.
|
||
| 1 | 2017-12-08 | lifecycle_msgs |
A package containing some lifecycle related message and service definitions.
A package containing some lifecycle related message and service definitions.
|
||
| 1 | 2017-12-08 | lifecycle |
Package containing demos for lifecycle implementation
Package containing demos for lifecycle implementation
|
||
| 1 | 2017-12-08 | launch_testing |
Helper scripts for tests that use the ROS launch tool.
Helper scripts for tests that use the ROS launch tool.
|
||
| 1 | 2017-12-08 | launch |
The ROS launch tool.
The ROS launch tool.
|
||
| 3 | 2017-12-08 | kdl_parser |
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
|
||
| 2 | 2017-12-08 | joy |
ROS2 driver for a generic Linux joystick.
Will contain a MacOS and Windows version later.
The joy package contains joy_node, a node that interfaces a
generic Linux joystick to ROS2. This node publishes a "Joy"
message, which contains the current state of each one of the
joystick's buttons and axes.
ROS2 driver for a generic Linux joystick.
Will contain a MacOS and Windows version later.
The joy package contains joy_node, a node that interfaces a
generic Linux joystick to ROS2. This node publishes a "Joy"
message, which contains the current state of each one of the
joystick's buttons and axes.
|
||
| 1 | 2017-12-08 | intra_process_demo |
Demonstrations of intra process communication.
Demonstrations of intra process communication.
|
||
| 1 | 2017-12-08 | image_tools |
Tools to capture and play back images to and from DDS subscriptions and publications.
Tools to capture and play back images to and from DDS subscriptions and publications.
|
||
| 2 | 2017-12-08 | geometry_msgs |
A package containing some geometry related message definitions.
A package containing some geometry related message definitions.
|
||
| 2 | 2017-12-08 | fastrtps_cmake_module |
Provide CMake module to find eProsima FastRTPS.
Provide CMake module to find eProsima FastRTPS.
|
||
| 1 | 2017-12-08 | examples_rclpy_minimal_subscriber |
Examples of minimal subscribers using rclpy.
Examples of minimal subscribers using rclpy.
|
||
| 1 | 2017-12-08 | examples_rclpy_minimal_service |
Examples of minimal service servers using rclpy.
Examples of minimal service servers using rclpy.
|
||
| 1 | 2017-12-08 | examples_rclpy_minimal_publisher |
Examples of minimal publishers using rclpy.
Examples of minimal publishers using rclpy.
|
||
| 1 | 2017-12-08 | examples_rclpy_minimal_client |
Examples of minimal service clients using rclpy.
Examples of minimal service clients using rclpy.
|
||
| 1 | 2017-12-08 | examples_rclpy_executors |
Examples of creating and using exectors to run multiple nodes in the same process
Examples of creating and using exectors to run multiple nodes in the same process
|
||
| 1 | 2017-12-08 | examples_rclcpp_minimal_timer |
Examples of minimal nodes which have timers
Examples of minimal nodes which have timers
|
||
| 1 | 2017-12-08 | examples_rclcpp_minimal_subscriber |
Examples of minimal subscribers
Examples of minimal subscribers
|
||
| 1 | 2017-12-08 | examples_rclcpp_minimal_service |
A minimal service server which adds two numbers
A minimal service server which adds two numbers
|
||
| 1 | 2017-12-08 | examples_rclcpp_minimal_publisher |
Examples of minimal publisher nodes
Examples of minimal publisher nodes
|
||
| 1 | 2017-12-08 | examples_rclcpp_minimal_composition |
Minimalist examples of composing nodes in the same
process
Minimalist examples of composing nodes in the same
process
|
||
| 1 | 2017-12-08 | examples_rclcpp_minimal_client |
Examples of minimal service clients
Examples of minimal service clients
|
||
| 1 | 2017-12-08 | example_interfaces |
Contains message and service definitions used by the examples.
Contains message and service definitions used by the examples.
|
||
| 1 | 2017-12-08 | dummy_sensors |
dummy sensor nodes
dummy sensor nodes
|
||
| 1 | 2017-12-08 | dummy_robot_bringup |
dummy robot bringup
dummy robot bringup
|
||
| 1 | 2017-12-08 | dummy_map_server |
dummy map server node
dummy map server node
|
||
| 2 | 2017-12-08 | diagnostic_msgs |
A package containing some diagnostics related message and service definitions.
A package containing some diagnostics related message and service definitions.
|
||
| 2 | 2017-12-08 | depthimage_to_laserscan |
depthimage_to_laserscan
depthimage_to_laserscan
|
||
| 1 | 2017-12-08 | demo_nodes_py |
Python nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
Python nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
|
||
| 1 | 2017-12-08 | demo_nodes_cpp_native |
C++ nodes which access the native handles of the rmw implemenation.
C++ nodes which access the native handles of the rmw implemenation.
|
||
| 1 | 2017-12-08 | demo_nodes_cpp |
C++ nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
C++ nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
|
||
| 2 | 2017-12-08 | connext_cmake_module |
Provide CMake module to find RTI Connext.
Provide CMake module to find RTI Connext.
|
||
| 1 | 2017-12-08 | composition |
Examples for composing multiple nodes in a single process.
Examples for composing multiple nodes in a single process.
|
||
| 1 | 2017-12-08 | common_interfaces |
common_interfaces contains messages and services that are widely used by other ROS packages.
common_interfaces contains messages and services that are widely used by other ROS packages.
|
||
| 2 | 2017-12-08 | cartographer_ros_msgs |
ROS messages for the cartographer_ros package.
ROS messages for the cartographer_ros package.
|
||
| 2 | 2017-12-08 | cartographer_ros |
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations. This package provides Cartographer's ROS integration.
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations. This package provides Cartographer's ROS integration.
|
||
| 2 | 2017-12-08 | cartographer |
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations.
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations.
|
||
| 1 | 2017-12-08 | builtin_interfaces |
A package containing builtin message and service definitions.
A package containing builtin message and service definitions.
|
||
| 2 | 2017-12-08 | astra_camera |
Drivers for Orbbec Astra Devices.
Drivers for Orbbec Astra Devices.
|
||
| 1 | 2017-12-08 | ament_uncrustify |
The ability to check code against style conventions using uncrustify
and generate xUnit test result files.
The ability to check code against style conventions using uncrustify
and generate xUnit test result files.
|
||
| 1 | 2017-12-08 | ament_tools |
The command line tools for the ament buildsystem.
The command line tools for the ament buildsystem.
|
||
| 1 | 2017-12-08 | ament_pyflakes |
The ability to check code using pyflakes and generate xUnit test
result files.
The ability to check code using pyflakes and generate xUnit test
result files.
|
||
| 1 | 2017-12-08 | ament_pep8 |
The ability to check code against the style conventions in PEP 8 and
generate xUnit test result files.
The ability to check code against the style conventions in PEP 8 and
generate xUnit test result files.
|
||
| 1 | 2017-12-08 | ament_pep257 |
The ability to check code against the style conventions in PEP 8 and
generate xUnit test result files.
The ability to check code against the style conventions in PEP 8 and
generate xUnit test result files.
|
||
| 1 | 2017-12-08 | ament_package |
The parser for the manifest files in the ament buildsystem.
The parser for the manifest files in the ament buildsystem.
|
||
| 1 | 2017-12-08 | ament_lint_common |
The list of commonly used linters in the ament buildsytem in CMake.
The list of commonly used linters in the ament buildsytem in CMake.
|
||
| 1 | 2017-12-08 | ament_lint_cmake |
The ability to lint CMake code using cmakelint and generate xUnit test
result files.
The ability to lint CMake code using cmakelint and generate xUnit test
result files.
|
||
| 1 | 2017-12-08 | ament_lint_auto |
The auto-magic functions for ease to use of the ament linters in CMake.
The auto-magic functions for ease to use of the ament linters in CMake.
|
||
| 1 | 2017-12-08 | ament_index_python |
Python API to access the ament resource index.
Python API to access the ament resource index.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-05-07 | depthcloud_encoder |
Point Cloud Encoder for Web-Based Streaming
Point Cloud Encoder for Web-Based Streaming
|
||
| 1 | 2019-05-07 | cv_camera |
cv_camera uses OpenCV capture object to capture camera image.
This supports camera_image and nodelet.
cv_camera uses OpenCV capture object to capture camera image.
This supports camera_image and nodelet.
|
||
| 2 | 2019-05-06 | rospy_message_converter |
Converts between Python dictionaries and JSON to rospy messages.
Converts between Python dictionaries and JSON to rospy messages.
|
||
| 1 | 2019-05-06 | hector_timestamp_alignment |
The hector_timestamp_alignment package
The hector_timestamp_alignment package
|
||
| 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
|
||
| 1 | 2019-05-06 | hector_gps_calibration |
The hector_gps_calibration package
The hector_gps_calibration package
|
||
| 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 | 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_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_elevation_visualization |
The hector_elevation_visualization package
The hector_elevation_visualization package
|
||
| 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_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_driving_aid_markers |
The hector_driving_aid_markers package
The hector_driving_aid_markers package
|
||
| 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-04 | sicktoolbox_wrapper |
sicktoolbox_wrapper is a ROS wrapper for the outstanding
sicktoolbox_wrapper is a ROS wrapper for the outstanding
|
||
| 1 | 2019-05-04 | sicktoolbox |
SICK Toolbox drivers for SICK laser rangefinders
This package contains the ROS fork of the SICK LIDAR Matlab/C++ Toolbox, available from
SICK Toolbox drivers for SICK laser rangefinders
This package contains the ROS fork of the SICK LIDAR Matlab/C++ Toolbox, available from
|
||
| 1 | 2019-04-30 | roslint |
CMake lint commands for ROS packages.
The lint commands perform static checking of Python or C++ source
code for errors and standards compliance.
CMake lint commands for ROS packages.
The lint commands perform static checking of Python or C++ source
code for errors and standards compliance.
|
||
| 1 | 2019-04-29 | msp |
Implementation of the MultiWii Serial Protocol (MSP)
Implementation of the MultiWii Serial Protocol (MSP)
|
||
| 1 | 2019-04-27 | pr2eus_tutorials |
pr2eus_tutorials
pr2eus_tutorials
|
||
| 1 | 2019-04-27 | pr2eus_openrave |
pr2eus_openrave
pr2eus_openrave
|
||
| 1 | 2019-04-27 | pr2eus_moveit |
pr2eus_moveit
pr2eus_moveit
|
||
| 1 | 2019-04-27 | pr2eus_impedance |
pr2eus_impedance
pr2eus_impedance
|
||
| 1 | 2019-04-27 | pr2eus_armnavigation |
pr2eus_armnavigation
pr2eus_armnavigation
|
||
| 1 | 2019-04-27 | pr2eus |
pr2eus
pr2eus
|
||
| 1 | 2019-04-27 | jsk_pr2eus |
|
||
| 1 | 2019-04-26 | fetch_teleop |
Teleoperation for fetch and freight.
Teleoperation for fetch and freight.
|
||
| 1 | 2019-04-26 | fetch_ros |
Fetch ROS, packages for working with Fetch and Freight
Fetch ROS, packages for working with Fetch and Freight
|
||
| 1 | 2019-04-26 | fetch_navigation |
Configuration and launch files for running ROS navigation on Fetch.
Configuration and launch files for running ROS navigation on Fetch.
|
||
| 1 | 2019-04-26 | fetch_moveit_config |
An automatically generated package with all the configuration and launch files for using the fetch_urdf with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the fetch_urdf with the MoveIt Motion Planning Framework
|
||
| 1 | 2019-04-26 | fetch_maps |
The fetch_maps package
The fetch_maps package
|
||
| 1 | 2019-04-26 | fetch_ikfast_plugin |
Kinematics plugin for Fetch robot, generated through IKFast
Kinematics plugin for Fetch robot, generated through IKFast
|
||
| 1 | 2019-04-26 | fetch_description |
URDF for Fetch Robot.
URDF for Fetch Robot.
|
||
| 1 | 2019-04-26 | fetch_depth_layer |
The fetch_depth_layer package
The fetch_depth_layer package
|
||
| 1 | 2019-04-26 | fetch_calibration |
Launch and configuration files for calibrating Fetch using the 'robot_calibration' package.
Launch and configuration files for calibrating Fetch using the 'robot_calibration' package.
|
||
| 1 | 2019-04-26 | fcl |
FCL is a collision checking library
FCL is a collision checking library
|
||
| 1 | 2019-04-25 | video_stream_opencv |
The video_stream_opencv package contains a node to publish a video stream (the protocols that
opencv supports are supported, including rtsp, webcams on /dev/video and video files) in ROS image topics, it supports camera info and basic image flipping (horizontal, vertical or both) capabilities, also adjusting publishing rate.
The video_stream_opencv package contains a node to publish a video stream (the protocols that
opencv supports are supported, including rtsp, webcams on /dev/video and video files) in ROS image topics, it supports camera info and basic image flipping (horizontal, vertical or both) capabilities, also adjusting publishing rate.
|
||
| 1 | 2019-04-22 | trac_ik_python |
The trac_ik_python package contains a python wrapper using SWIG
for trac_ik_lib
The trac_ik_python package contains a python wrapper using SWIG
for trac_ik_lib
|
||
| 1 | 2019-04-22 | trac_ik_lib |
TRAC-IK is a faster, significantly more reliable drop-in replacement for
KDL's pseudoinverse Jacobian solver.
The TRAC-IK library has a very similar API to KDL's IK solver calls,
except that the user passes a maximum time instead of a maximum number of
search iterations. Additionally, TRAC-IK allows for error tolerances to
be set independently for each Cartesian dimension (x,y,z,roll,pitch.yaw).
TRAC-IK is a faster, significantly more reliable drop-in replacement for
KDL's pseudoinverse Jacobian solver.
The TRAC-IK library has a very similar API to KDL's IK solver calls,
except that the user passes a maximum time instead of a maximum number of
search iterations. Additionally, TRAC-IK allows for error tolerances to
be set independently for each Cartesian dimension (x,y,z,roll,pitch.yaw).
|
||
| 1 | 2019-04-22 | trac_ik_kinematics_plugin |
A MoveIt! Kinematics plugin using TRAC-IK
A MoveIt! Kinematics plugin using TRAC-IK
|
||
| 1 | 2019-04-22 | trac_ik_examples |
This package contains the source code for testing and comparing trac_ik
This package contains the source code for testing and comparing trac_ik
|
||
| 1 | 2019-04-22 | trac_ik |
The ROS packages in this repository were created to provide an improved
alternative Inverse Kinematics solver to the popular inverse Jacobian
methods in KDL. TRAC-IK handles joint-limited chains better than KDL
without increasing solve time.
The ROS packages in this repository were created to provide an improved
alternative Inverse Kinematics solver to the popular inverse Jacobian
methods in KDL. TRAC-IK handles joint-limited chains better than KDL
without increasing solve time.
|
||
| 1 | 2019-04-22 | opencv_apps |
|
||
| 2 | 2019-04-18 | grid_map_visualization |
Configurable tool to visualize grid maps in RViz.
Configurable tool to visualize grid maps in RViz.
|
||
| 2 | 2019-04-18 | grid_map_sdf |
Generates signed distance fields from grid maps.
Generates signed distance fields from grid maps.
|
||
| 2 | 2019-04-18 | grid_map_rviz_plugin |
RViz plugin for displaying grid map messages.
RViz plugin for displaying grid map messages.
|
||
| 2 | 2019-04-18 | grid_map_ros |
ROS interface for the grid map library to manage two-dimensional grid maps with multiple data layers.
ROS interface for the grid map library to manage two-dimensional grid maps with multiple data layers.
|
||
| 2 | 2019-04-18 | grid_map_pcl |
Conversions between grid maps and Point Cloud Library (PCL) types.
Conversions between grid maps and Point Cloud Library (PCL) types.
|
||
| 2 | 2019-04-18 | grid_map_octomap |
Conversions between grid maps and OctoMap types.
Conversions between grid maps and OctoMap types.
|
||
| 2 | 2019-04-18 | grid_map_msgs |
Definition of the multi-layered grid map message type.
Definition of the multi-layered grid map message type.
|
||
| 2 | 2019-04-18 | grid_map_loader |
Loading and publishing grid maps from bag files.
Loading and publishing grid maps from bag files.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-04-27 | pr2eus_openrave |
pr2eus_openrave
pr2eus_openrave
|
||
| 1 | 2019-04-27 | pr2eus_moveit |
pr2eus_moveit
pr2eus_moveit
|
||
| 1 | 2019-04-27 | pr2eus_impedance |
pr2eus_impedance
pr2eus_impedance
|
||
| 1 | 2019-04-27 | pr2eus_armnavigation |
pr2eus_armnavigation
pr2eus_armnavigation
|
||
| 1 | 2019-04-27 | pr2eus |
pr2eus
pr2eus
|
||
| 1 | 2019-04-27 | jsk_pr2eus |
|
||
| 1 | 2019-04-26 | fcl |
FCL is a collision checking library
FCL is a collision checking library
|
||
| 1 | 2019-04-25 | video_stream_opencv |
The video_stream_opencv package contains a node to publish a video stream (the protocols that
opencv supports are supported, including rtsp, webcams on /dev/video and video files) in ROS image topics, it supports camera info and basic image flipping (horizontal, vertical or both) capabilities, also adjusting publishing rate.
The video_stream_opencv package contains a node to publish a video stream (the protocols that
opencv supports are supported, including rtsp, webcams on /dev/video and video files) in ROS image topics, it supports camera info and basic image flipping (horizontal, vertical or both) capabilities, also adjusting publishing rate.
|
||
| 1 | 2019-04-24 | pr2_self_test_msgs |
Messages used in PR2 hardware testing.
Messages used in PR2 hardware testing.
|
||
| 1 | 2019-04-24 | pr2_self_test |
The pr2_self_test package
The pr2_self_test package
|
||
| 1 | 2019-04-24 | pr2_motor_diagnostic_tool |
pr2_motor_diagnostic_tool
pr2_motor_diagnostic_tool
|
||
| 1 | 2019-04-24 | pr2_counterbalance_check |
pr2_counterbalance_check
pr2_counterbalance_check
|
||
| 1 | 2019-04-24 | pr2_bringup_tests |
Complete functionality tests for PR2. Contains utilities designed to test and verify devices, mechanicals and sensors.
Complete functionality tests for PR2. Contains utilities designed to test and verify devices, mechanicals and sensors.
|
||
| 1 | 2019-04-24 | joint_qualification_controllers |
Controllers used in PR2 hardware testing. For testing counterbalance of PR2, and for internal WG use.
Controllers used in PR2 hardware testing. For testing counterbalance of PR2, and for internal WG use.
|
||
| 1 | 2019-04-18 | rosserial_leonardo_cmake |
CMake scripts for building Arduino Leonardo (atmega32u4) Firmwares
CMake scripts for building Arduino Leonardo (atmega32u4) Firmwares
|
||
| 1 | 2019-04-16 | jsk_teleop_joy |
jsk_teleop_joy
jsk_teleop_joy
|
||
| 1 | 2019-04-16 | jsk_ik_server |
jsk_ik_server
jsk_ik_server
|
||
| 1 | 2019-04-16 | jsk_footstep_planner |
jsk_footstep_planner
jsk_footstep_planner
|
||
| 1 | 2019-04-16 | jsk_footstep_controller |
The jsk_footstep_controller package
The jsk_footstep_controller package
|
||
| 1 | 2019-04-16 | jsk_control |
The jsk_control package
The jsk_control package
|
||
| 1 | 2019-04-16 | jsk_calibration |
The jsk_calibration package
The jsk_calibration package
|
||
| 1 | 2019-04-16 | joy_mouse |
The joy_mouse package
The joy_mouse package
|
||
| 1 | 2019-04-16 | eus_qpoases |
eus_qpoases
eus_qpoases
|
||
| 1 | 2019-04-16 | eus_qp |
eus_qp is an interface of euslisp to solve qp problems with linear constraints.
eus_qp is an interface of euslisp to solve qp problems with linear constraints.
|
||
| 1 | 2019-04-16 | eus_nlopt |
eus_nlopt
eus_nlopt
|
||
| 1 | 2019-04-16 | contact_states_observer |
The contact_states_observer package
The contact_states_observer package
|
||
| 1 | 2019-04-16 | cmd_vel_smoother |
The cmd_vel_smoother package
The cmd_vel_smoother package
|
||
| 1 | 2019-04-15 | robotnik_msgs |
The robotnik_msgs package. Common messages and services used by some Robotnik's packages.
The robotnik_msgs package. Common messages and services used by some Robotnik's packages.
|
||
| 1 | 2019-04-03 | multisense_ros |
multisense_ros
multisense_ros
|
||
| 1 | 2019-04-03 | multisense_lib |
multisense_lib
multisense_lib
|
||
| 1 | 2019-04-03 | multisense_description |
multisense_description
multisense_description
|
||
| 1 | 2019-04-03 | multisense_cal_check |
multisense_cal_check
multisense_cal_check
|
||
| 1 | 2019-04-03 | multisense_bringup |
multisense_bringup
multisense_bringup
|
||
| 1 | 2019-04-03 | multisense |
multisense catkin driver
multisense catkin driver
|
||
| 1 | 2019-04-03 | moveit_resources |
Resources used for MoveIt! testing
Resources used for MoveIt! testing
|
||
| 1 | 2019-04-02 | roseus_tutorials |
roseus_tutorials
roseus_tutorials
|
||
| 1 | 2019-04-02 | roseus_smach |
roseus_smach
* Euslisp state machine class. it will be moved.
* Message publisher for visualizing current state by smach_viewer.
* Simple pickle dump script for debugging state machine.
* Execute state machine as a action server.
roseus_smach
* Euslisp state machine class. it will be moved.
* Message publisher for visualizing current state by smach_viewer.
* Simple pickle dump script for debugging state machine.
* Execute state machine as a action server.
|
||
| 1 | 2019-04-02 | roseus_mongo |
The roseus_mongo package
The roseus_mongo package
|
||
| 1 | 2019-04-02 | roseus |
EusLisp client for ROS Robot Operating System.
EusLisp client for ROS Robot Operating System.
|
||
| 1 | 2019-04-02 | pr2_navigation_apps |
The pr2_navigation_apps package
The pr2_navigation_apps package
|
||
| 1 | 2019-04-02 | pr2_2dnav_slam |
This application allows the PR2 to navigate autonomously while also building a map of its environment as it drives along.
This application allows the PR2 to navigate autonomously while also building a map of its environment as it drives along.
|
||
| 1 | 2019-04-02 | pr2_2dnav_local |
This application allows the PR2 to navigate autonomously in an odometric frame.
This application allows the PR2 to navigate autonomously in an odometric frame.
|
||
| 1 | 2019-04-02 | pr2_2dnav |
This application allows the PR2 robot to navigate autonomously with a pre-specified static map.
This application allows the PR2 robot to navigate autonomously with a pre-specified static map.
|
||
| 1 | 2019-04-02 | jsk_roseus |
|
||
| 1 | 2019-03-29 | novatel_span_driver |
Python driver for NovAtel SPAN devices.
Python driver for NovAtel SPAN devices.
|
||
| 1 | 2019-03-29 | novatel_msgs |
ROS messages which represent raw Novatel SPAN data.
ROS messages which represent raw Novatel SPAN data.
|
||
| 1 | 2019-03-28 | random_numbers |
This library contains wrappers for generating floating point values, integers, quaternions using boost libraries.
The constructor of the wrapper is guaranteed to be thread safe and initialize its random number generator to a random seed.
Seeds are obtained using a separate and different random number generator.
This library contains wrappers for generating floating point values, integers, quaternions using boost libraries.
The constructor of the wrapper is guaranteed to be thread safe and initialize its random number generator to a random seed.
Seeds are obtained using a separate and different random number generator.
|
||
| 1 | 2019-03-25 | p2os_urdf |
URDF file descriptions for P2OS/ARCOS robot
URDF file descriptions for P2OS/ARCOS robot
|
||
| 1 | 2019-03-25 | p2os_teleop |
A teleoperation node for the p2os_driver package.
A teleoperation node for the p2os_driver package.
|
||
| 1 | 2019-03-25 | p2os_msgs |
Defines the messages that are used to communicate with the
p2os_driver package and the ROS infrastructure.
Defines the messages that are used to communicate with the
p2os_driver package and the ROS infrastructure.
|