Packages

Name Description
1 2018-09-14 ethercat_grant
Makes it possible to run the ros_ethercat_loop without using sudo. Forked from pr2-grant
Makes it possible to run the ros_ethercat_loop without using sudo. Forked from pr2-grant
 
1 2019-04-23 epos2_motor_controller
EPOS2 motor controller driver
EPOS2 motor controller driver
 
1 2017-03-28 eigen_stl_containers
This package provides a set of typedef's that allow using Eigen datatypes in STL containers
This package provides a set of typedef's that allow using Eigen datatypes in STL containers
 
1 2019-04-26 eigen_conversions
Conversion functions between: - Eigen and KDL - Eigen and geometry_msgs.
Conversion functions between: - Eigen and KDL - Eigen and geometry_msgs.
 
1 2019-04-11 effort_controllers
effort_controllers
effort_controllers
 
1 2018-09-11 ecl_utilities
Includes various supporting tools and utilities for c++ programming.
Includes various supporting tools and utilities for c++ programming.
 
1 2018-09-11 ecl_type_traits
Extends c++ type traits and implements a few more to boot.
Extends c++ type traits and implements a few more to boot.
 
1 2017-08-06 ecl_tools
Tools and utilities for ecl development.
Tools and utilities for ecl development.
 
1 2016-06-15 ecl_time_lite
Provides a portable set of time functions that are especially useful for porting other code or being wrapped by higher level c++ classes.
Provides a portable set of time functions that are especially useful for porting other code or being wrapped by higher level c++ classes.
 
1 2018-09-11 ecl_time
Timing utilities are very dependent on the system api provided for their use. This package provides a means for handling different timing models. Current support - posix rt : complete. - macosx : posix timers only, missing absolute timers. - win : none.
Timing utilities are very dependent on the system api provided for their use. This package provides a means for handling different timing models. Current support - posix rt : complete. - macosx : posix timers only, missing absolute timers. - win : none.
 
1 2018-09-11 ecl_threads
This package provides the c++ extensions for a variety of threaded programming tools. These are usually different on different platforms, so the architecture for a cross-platform framework is also implemented.
This package provides the c++ extensions for a variety of threaded programming tools. These are usually different on different platforms, so the architecture for a cross-platform framework is also implemented.
 
1 2018-09-11 ecl_streams
These are lightweight text streaming classes that connect to standardised ecl type devices.
These are lightweight text streaming classes that connect to standardised ecl type devices.
 
1 2018-09-11 ecl_statistics
Common statistical structures and algorithms for control systems.
Common statistical structures and algorithms for control systems.
 
1 2016-06-15 ecl_sigslots_lite
This avoids use of dynamic storage (malloc/new) and thread safety (mutexes) to provide a very simple sigslots implementation that can be used for *very* embedded development.
This avoids use of dynamic storage (malloc/new) and thread safety (mutexes) to provide a very simple sigslots implementation that can be used for *very* embedded development.
 
1 2018-09-11 ecl_sigslots
Provides a signal/slot mechanism (in the same vein as qt sigslots, boost::signals etc for intra-process communication. These include some improvements - they do not need a preprocessor, are fully type safe, allow for simple connections via a posix style string identifier and are multithread-safe.
Provides a signal/slot mechanism (in the same vein as qt sigslots, boost::signals etc for intra-process communication. These include some improvements - they do not need a preprocessor, are fully type safe, allow for simple connections via a posix style string identifier and are multithread-safe.
 
1 2016-11-08 ecl_navigation
This stack aims to bring the common tools and algorithms needed to develop navigation algorithms, in particular slam. It does not focus on the end-point solution, rather the tools needed to create a variety of end-point solutions.
This stack aims to bring the common tools and algorithms needed to develop navigation algorithms, in particular slam. It does not focus on the end-point solution, rather the tools needed to create a variety of end-point solutions.
 
1 2018-09-11 ecl_mpl
Metaprogramming tools move alot of runtime calculations to be shifted to compile time. This has only very elementary structures at this stage.
Metaprogramming tools move alot of runtime calculations to be shifted to compile time. This has only very elementary structures at this stage.
 
2 2016-11-08 ecl_mobile_robot
Contains transforms (e.g. differential drive inverse kinematics) for the various types of mobile robot platforms.
Contains transforms (e.g. differential drive inverse kinematics) for the various types of mobile robot platforms.
 
1 2018-09-11 ecl_math
This package provides simple support to cmath, filling in holes or redefining in a c++ formulation where desirable.
This package provides simple support to cmath, filling in holes or redefining in a c++ formulation where desirable.
 
2 2018-09-11 ecl_manipulators
Deploys various manipulation algorithms, currently just feedforward filters (interpolations).
Deploys various manipulation algorithms, currently just feedforward filters (interpolations).
 
1 2018-09-11 ecl_manipulation
Includes basic manipulation related structures as well as a few algorithms currently used at Yujin Robot.
Includes basic manipulation related structures as well as a few algorithms currently used at Yujin Robot.
 
1 2016-06-15 ecl_lite
Libraries and utilities for embedded and low-level linux development.
Libraries and utilities for embedded and low-level linux development.
 
1 2018-09-11 ecl_linear_algebra
Ecl frontend to a linear matrix package (currently eigen).
Ecl frontend to a linear matrix package (currently eigen).
 
1 2017-08-06 ecl_license
Maintains the ecl licenses and also provides an install target for deploying licenses with the ecl libraries.
Maintains the ecl licenses and also provides an install target for deploying licenses with the ecl libraries.
 
1 2018-09-11 ecl_ipc
Interprocess mechanisms vary greatly across platforms - sysv, posix, win32, there are more than a few. This package provides an infrastructure to allow for developing cross platform c++ wrappers around the lower level c api's that handle these mechanisms. These make it not only easier to utilise such mechanisms, but allow it to be done consistently across platforms.
Interprocess mechanisms vary greatly across platforms - sysv, posix, win32, there are more than a few. This package provides an infrastructure to allow for developing cross platform c++ wrappers around the lower level c api's that handle these mechanisms. These make it not only easier to utilise such mechanisms, but allow it to be done consistently across platforms.
 
1 2016-06-15 ecl_io
Most implementations (windows, posix, ...) have slightly different api for low level input-output functions. These are gathered here and re-represented with a cross platform set of functions.
Most implementations (windows, posix, ...) have slightly different api for low level input-output functions. These are gathered here and re-represented with a cross platform set of functions.
 
1 2018-09-11 ecl_geometry
Any tools relating to mathematical geometry. Primarily featuring polynomials and interpolations.
Any tools relating to mathematical geometry. Primarily featuring polynomials and interpolations.
 
1 2018-09-11 ecl_formatters
The formatters here simply format various input types to a specified text format. They can be used with most streaming types (including both ecl and stl streams).
The formatters here simply format various input types to a specified text format. They can be used with most streaming types (including both ecl and stl streams).
 
1 2018-09-11 ecl_filesystem
Cross platform filesystem utilities (until c++11 makes its way in).
Cross platform filesystem utilities (until c++11 makes its way in).
 
1 2018-09-11 ecl_exceptions
Template based exceptions - these are simple and practical and avoid the proliferation of exception types. Although not syntatactically ideal, it is convenient and eminently practical.
Template based exceptions - these are simple and practical and avoid the proliferation of exception types. Although not syntatactically ideal, it is convenient and eminently practical.
 
1 2016-06-15 ecl_errors
This library provides lean and mean error mechanisms. It includes c style error functions as well as a few useful macros. For higher level mechanisms, refer to ecl_exceptions.
This library provides lean and mean error mechanisms. It includes c style error functions as well as a few useful macros. For higher level mechanisms, refer to ecl_exceptions.
 
1 2018-09-11 ecl_eigen
This provides an Eigen implementation for ecl's linear algebra.
This provides an Eigen implementation for ecl's linear algebra.
 
1 2018-09-11 ecl_devices
Provides an extensible and standardised framework for input-output devices.
Provides an extensible and standardised framework for input-output devices.
 
1 2018-09-11 ecl_core_apps
This includes a suite of programs demo'ing various aspects of the ecl_core. It also includes various benchmarking and utility programs for use primarily with embedded systems.
This includes a suite of programs demo'ing various aspects of the ecl_core. It also includes various benchmarking and utility programs for use primarily with embedded systems.
 
1 2018-09-11 ecl_core
A set of tools and interfaces extending the capabilities of c++ to provide a lightweight, consistent interface with a focus for control programming.
A set of tools and interfaces extending the capabilities of c++ to provide a lightweight, consistent interface with a focus for control programming.
 
1 2016-06-15 ecl_converters_lite
These are a very simple version of some of the functions in ecl_converters suitable for firmware development. That is, there is no use of new, templates or exceptions.
These are a very simple version of some of the functions in ecl_converters suitable for firmware development. That is, there is no use of new, templates or exceptions.
 
1 2018-09-11 ecl_converters
Some fast/convenient type converters, mostly for char strings or strings. These are not really fully fleshed out, alot of them could use the addition for the whole range of fundamental types (e.g. all integers, not just int, unsigned int). They will come as the need arises.
Some fast/convenient type converters, mostly for char strings or strings. These are not really fully fleshed out, alot of them could use the addition for the whole range of fundamental types (e.g. all integers, not just int, unsigned int). They will come as the need arises.
 
1 2018-09-11 ecl_containers
The containers included here are intended to extend the stl containers. In all cases, these implementations are designed to implement c++ conveniences and safety where speed is not sacrificed. Also includes techniques for memory debugging of common problems such as buffer overruns.
The containers included here are intended to extend the stl containers. In all cases, these implementations are designed to implement c++ conveniences and safety where speed is not sacrificed. Also includes techniques for memory debugging of common problems such as buffer overruns.
 
1 2016-06-15 ecl_console
Color codes for ansii consoles.
Color codes for ansii consoles.
 
1 2016-06-15 ecl_config
These tools inspect and describe your system with macros, types and functions.
These tools inspect and describe your system with macros, types and functions.
 
1 2018-09-11 ecl_concepts
Introduces a compile time concept checking mechanism that can be used most commonly to check for required functionality when passing template arguments.
Introduces a compile time concept checking mechanism that can be used most commonly to check for required functionality when passing template arguments.
 
1 2018-09-11 ecl_command_line
Embeds the TCLAP library inside the ecl. This is a very convenient command line parser in templatised c++.
Embeds the TCLAP library inside the ecl. This is a very convenient command line parser in templatised c++.
 
1 2017-08-06 ecl_build
Collection of cmake/make build tools primarily for ecl development itself, but also contains a few cmake modules useful outside of the ecl.
Collection of cmake/make build tools primarily for ecl development itself, but also contains a few cmake modules useful outside of the ecl.
 
1 2018-09-11 ecl
Metapackage bringing all of ecl together.
Metapackage bringing all of ecl together.
 
1 2019-04-25 eca_a9_gazebo
Package with launch files for demonstrations with the ECA A9 AUV
Package with launch files for demonstrations with the ECA A9 AUV
 
1 2019-04-25 eca_a9_description
Robot description for the ECA A9 AUV
Robot description for the ECA A9 AUV
 
1 2019-04-25 eca_a9_control
Configuration and launch files to control the ECA A9 AUV
Configuration and launch files to control the ECA A9 AUV
 
1 2016-07-23 easy_markers
Python library to assist in publishing markers easily
Python library to assist in publishing markers easily
 
1 2019-01-03 dynamixel_workbench_toolbox
This package is composed of 'dynamixel_item', 'dynamixel_tool', 'dynamixel_driver' and 'dynamixel_workbench' class. The 'dynamixel_item' is saved as control table item and information of Dynamixels. The 'dynamixel_tool' class loads its by model number of Dynamixels. The 'dynamixel_driver' class includes wraped function used in DYNAMIXEL SDK. The 'dynamixel_workbench' class make simple to use Dynamixels
This package is composed of 'dynamixel_item', 'dynamixel_tool', 'dynamixel_driver' and 'dynamixel_workbench' class. The 'dynamixel_item' is saved as control table item and information of Dynamixels. The 'dynamixel_tool' class loads its by model number of Dynamixels. The 'dynamixel_driver' class includes wraped function used in DYNAMIXEL SDK. The 'dynamixel_workbench' class make simple to use Dynamixels
 
1 2019-01-03 dynamixel_workbench_single_manager_gui
It provides a grapic user interface to check the status of Dynamixel and control it before using Dynamixel
It provides a grapic user interface to check the status of Dynamixel and control it before using Dynamixel
 

Packages

Name Description
2 2018-12-01 openni2_launch
Launch files to start the openni2_camera drivers using rgbd_launch.
Launch files to start the openni2_camera drivers using rgbd_launch.
 
1 2018-12-01 openni2_camera
Drivers for the Asus Xtion and Primesense Devices. For using a kinect with ROS, try the
Drivers for the Asus Xtion and Primesense Devices. For using a kinect with ROS, try the
 
2 2019-04-10 openhrp3
 
1 2018-01-07 opengm
This package wraps the external c++ library opengm in a ROS package, so other packages can use it. It downloads the source code of it and then unzips it. The library is a header-only library with command line interfaces, which aren't used, so it doesn't gets build. For further descriptions and tutorials see the Makefile.tarball and https://github.com/opengm/opengm . Copyright (C) 2013 Bjoern Andres, Thorsten Beier and Joerg H.~Kappes.
This package wraps the external c++ library opengm in a ROS package, so other packages can use it. It downloads the source code of it and then unzips it. The library is a header-only library with command line interfaces, which aren't used, so it doesn't gets build. For further descriptions and tutorials see the Makefile.tarball and https://github.com/opengm/opengm . Copyright (C) 2013 Bjoern Andres, Thorsten Beier and Joerg H.~Kappes.
 
1 2016-10-02 opencv_candidate
Experimental OpenCV functions
Experimental OpenCV functions
 
1 2019-04-22 opencv_apps
 
1 2019-02-08 open_manipulator_with_tb3_waffle_pi_moveit
An automatically generated package with all the configuration and launch files for using the om_with_tb3 with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the om_with_tb3 with the MoveIt! Motion Planning Framework
 
1 2019-02-08 open_manipulator_with_tb3_waffle_moveit
An automatically generated package with all the configuration and launch files for using the om_with_tb3 with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the om_with_tb3 with the MoveIt! Motion Planning Framework
 
1 2019-02-08 open_manipulator_with_tb3_tools
The tools package(including SLAM, Navigation, Manipulation) for OpenManipulator with TurtleBot3
The tools package(including SLAM, Navigation, Manipulation) for OpenManipulator with TurtleBot3
 
1 2019-02-08 open_manipulator_with_tb3_simulations
Simulation packages for OpenManipulator with TurtleBot3
Simulation packages for OpenManipulator with TurtleBot3
 
1 2019-02-08 open_manipulator_with_tb3_msgs
Messages and services package for OpenManipulator with TurtleBot3
Messages and services package for OpenManipulator with TurtleBot3
 
1 2019-02-08 open_manipulator_with_tb3_gazebo
Simulation package using gazebo for OpenManipulator with TurtleBot3
Simulation package using gazebo for OpenManipulator with TurtleBot3
 
1 2019-02-08 open_manipulator_with_tb3_description
OpenManipulator 3D model description for visualization and simulation
OpenManipulator 3D model description for visualization and simulation
 
1 2019-02-08 open_manipulator_with_tb3
ROS-enabled OpenManipulator is a full open robot platform consisting of OpenSoftware​, OpenHardware and OpenCR(Embedded board)​. The OpenManipulator is allowed users to control it more easily by linking with the MoveIt! package. Moreover it has full hardware compatibility with TurtleBot3​. Even if you do not have a real robot, you can control the robot in the Gazebo simulator​.
ROS-enabled OpenManipulator is a full open robot platform consisting of OpenSoftware​, OpenHardware and OpenCR(Embedded board)​. The OpenManipulator is allowed users to control it more easily by linking with the MoveIt! package. Moreover it has full hardware compatibility with TurtleBot3​. Even if you do not have a real robot, you can control the robot in the Gazebo simulator​.
 
1 2019-02-17 open_manipulator_teleop
Provides teleoperation using keyboard for OpenManipulator.
Provides teleoperation using keyboard for OpenManipulator.
 
1 2019-02-07 open_manipulator_simulations
Simulation packages for OpenManipulator
Simulation packages for OpenManipulator
 
1 2019-02-17 open_manipulator_position_ctrl
This packages based on MoveIt! framework to manipulate OpenManipulator
This packages based on MoveIt! framework to manipulate OpenManipulator
 
1 2018-05-31 open_manipulator_perceptions
This packages are configured to related perception packages as AR marker, Object recognition and so on.
This packages are configured to related perception packages as AR marker, Object recognition and so on.
 
1 2019-02-07 open_manipulator_msgs
Messages and services package for OpenManipulator to send information about state or pose
Messages and services package for OpenManipulator to send information about state or pose
 
1 2019-02-17 open_manipulator_moveit
An automatically generated package with all the configuration and launch files for using the open_manipulator with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the open_manipulator with the MoveIt! Motion Planning Framework
 
1 2019-02-17 open_manipulator_libs
OpenManipulator library (Kinematics lib., Dynamixel lib., Drawing path lib.)
OpenManipulator library (Kinematics lib., Dynamixel lib., Drawing path lib.)
 
1 2019-02-07 open_manipulator_gazebo
Gazebo configurations package for OpenManipulator
Gazebo configurations package for OpenManipulator
 
1 2019-02-17 open_manipulator_dynamixel_ctrl
The Dynamixel controller package based on Dynamixel-Workbench for OpenManipulator.
The Dynamixel controller package based on Dynamixel-Workbench for OpenManipulator.
 
1 2019-02-17 open_manipulator_description
OpenManipulator 3D model description for visualization and simulation
OpenManipulator 3D model description for visualization and simulation
 
1 2019-02-17 open_manipulator_controller
OpenManipulator controller package
OpenManipulator controller package
 
1 2019-02-17 open_manipulator_control_gui
OpenManipulator GUI control package based on QT
OpenManipulator GUI control package based on QT
 
1 2018-05-31 open_manipulator_ar_markers
To find AR marker, it depends ar_track_alvar packages
To find AR marker, it depends ar_track_alvar packages
 
1 2019-02-17 open_manipulator
ROS-enabled OpenManipulator is a full open robot platform consisting of OpenSoftware​, OpenHardware and OpenCR(Embedded board)​. The OpenManipulator is allowed users to control it more easily by linking with the MoveIt! package. Moreover it has full hardware compatibility with TurtleBot3​. Even if you do not have a real robot, you can control the robot in the Gazebo simulator​.
ROS-enabled OpenManipulator is a full open robot platform consisting of OpenSoftware​, OpenHardware and OpenCR(Embedded board)​. The OpenManipulator is allowed users to control it more easily by linking with the MoveIt! package. Moreover it has full hardware compatibility with TurtleBot3​. Even if you do not have a real robot, you can control the robot in the Gazebo simulator​.
 
1 2017-12-11 open_karto
Catkinized ROS packaging of the OpenKarto library
Catkinized ROS packaging of the OpenKarto library
 
1 2018-03-26 open_cr_module
The open_cr_module package
The open_cr_module package
 
1 2018-04-19 op3_web_setting_tool
The op3_web_setting_tool package
The op3_web_setting_tool package
 
1 2018-03-20 op3_walking_module_msgs
This package includes ROS messages and services for the ROBOTIS OP3 packages
This package includes ROS messages and services for the ROBOTIS OP3 packages
 
1 2018-03-26 op3_walking_module
The op3_walking_module package
The op3_walking_module package
 
1 2018-03-20 op3_online_walking_module_msgs
This package includes ROS messages and services for the ROBOTIS OP3 packages
This package includes ROS messages and services for the ROBOTIS OP3 packages
 
1 2018-03-26 op3_online_walking_module
The op3_online_walking_module package
The op3_online_walking_module package
 
1 2018-04-19 op3_offset_tuner_server
The offset_tuner_server package
The offset_tuner_server package
 
1 2018-03-20 op3_offset_tuner_msgs
This package includes ROS messages and services for the ROBOTIS OP3 packages
This package includes ROS messages and services for the ROBOTIS OP3 packages
 
1 2018-04-19 op3_offset_tuner_client
The op3_offset_tuner_client package
The op3_offset_tuner_client package
 
1 2018-04-19 op3_navigation
This package is for generating footsteps of ROBOTIS-OP3. It has several config files and launch files in order to use footstep planner package.
This package is for generating footsteps of ROBOTIS-OP3. It has several config files and launch files in order to use footstep planner package.
 
1 2018-03-26 op3_manager
The op3_manager package
The op3_manager package
 
1 2018-03-26 op3_localization
The op3_localization package
The op3_localization package
 
1 2018-03-26 op3_kinematics_dynamics
The op3_kinematics_dynamics package
The op3_kinematics_dynamics package
 
1 2018-03-26 op3_head_control_module
The op3_head_control_module package
The op3_head_control_module package
 
1 2018-04-19 op3_gui_demo
The op3_gui_demo is a GUI software to control ROBOTIS-OP3. Within this program, user can perform module settings, walking tuner, head joint control and play actions.
The op3_gui_demo is a GUI software to control ROBOTIS-OP3. Within this program, user can perform module settings, walking tuner, head joint control and play actions.
 
1 2018-03-25 op3_gazebo
The op3_gazebo package
The op3_gazebo package
 
1 2018-03-26 op3_direct_control_module
The op3_direct_control_module package
The op3_direct_control_module package
 
1 2018-03-25 op3_description
The op3_description package
The op3_description package
 
1 2018-04-19 op3_demo
OP3 default demo It includes three demontrations(soccer demo, vision demo, action script demo)
OP3 default demo It includes three demontrations(soccer demo, vision demo, action script demo)
 
1 2018-04-19 op3_camera_setting_tool
The op3_camera_setting_tool package
The op3_camera_setting_tool package
 
1 2018-04-19 op3_bringup
This package is a demo for first time users. There is an example in the demo where you can run and visualize the robot.
This package is a demo for first time users. There is an example in the demo where you can run and visualize the robot.
 

Packages

Name Description
1 2019-03-25 pal_interaction_msgs
This package defines messages used by the PAL interaction tools.
This package defines messages used by the PAL interaction tools.
 
1 2019-03-25 pal_device_msgs
This package defines messages used by PAL devices and drivers.
This package defines messages used by PAL devices and drivers.
 
1 2019-03-25 pal_detection_msgs
This package defines messages used by the pal face detection and recognition.
This package defines messages used by the pal face detection and recognition.
 
1 2019-03-25 pal_control_msgs
This package defines messages used to control PAL robots.
This package defines messages used to control PAL robots.
 
1 2019-03-25 pal_common_msgs
This package defines generic messages used by PAL nodes.
This package defines generic messages used by PAL nodes.
 
1 2019-03-25 pal_behaviour_msgs
This package defines messages used to interact with PAL robots.
This package defines messages used to interact with PAL robots.
 
1 2018-10-04 pacmod_msgs
Message definition files for the PACMod driver
Message definition files for the PACMod driver
 
1 2018-08-31 pacmod_game_control
ROS Package for controlling the AStuff PACMod with a Joystick
ROS Package for controlling the AStuff PACMod with a Joystick
 
1 2019-05-17 pacmod3
AutonomouStuff PACMod v3 Driver Package
AutonomouStuff PACMod v3 Driver Package
 
1 2018-04-25 pacmod
AutonomouStuff PACMod driver package
AutonomouStuff PACMod driver package
 
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.
 
1 2019-03-25 p2os_launch
Launch and config files designed for use with the p2os stack.
Launch and config files designed for use with the p2os stack.
 
1 2019-03-25 p2os_driver
Driver file descriptions for P2OS/ARCOS robot
Driver file descriptions for P2OS/ARCOS robot
 
1 2019-03-25 p2os_doc
Contains the Documentation for the p2os driver/componenets
Contains the Documentation for the p2os driver/componenets
 
1 2018-12-21 oxford_gps_eth
Ethernet interface to OxTS GPS receivers (NCOM packet structure)
Ethernet interface to OxTS GPS receivers (NCOM packet structure)
 
1 2017-12-06 osm_cartography
Geographic mapping using Open Street Map data.
Geographic mapping using Open Street Map data.
 
1 2015-09-16 osg_utils
osg_utils is a library that contains some classes that may be useful in ROS-OSG applications.
osg_utils is a library that contains some classes that may be useful in ROS-OSG applications.
 
1 2015-09-16 osg_markers
osg_markers can be used to create Markers geometry in OSG.
osg_markers can be used to create Markers geometry in OSG.
 
1 2015-09-16 osg_interactive_markers
This package is basically an OpenSceneGraph (OSG) adaptation of the Interactive Markers client writen for rviz/Ogre.
This package is basically an OpenSceneGraph (OSG) adaptation of the Interactive Markers client writen for rviz/Ogre.
 
1 2015-04-10 orogen
orogen offers a specification interface for components developped in the Orocos Realtime Toolkit. Moreover, it generates the specified modules, thus offering an easy and fast development process.
orogen offers a specification interface for components developped in the Orocos Realtime Toolkit. Moreover, it generates the specified modules, thus offering an easy and fast development process.
 
1 2017-03-24 orocos_toolchain
This package provides the entire orocos_toolchain
This package provides the entire orocos_toolchain
 
1 2019-03-04 orocos_kinematics_dynamics
This package depends on a recent version of the Kinematics and Dynamics Library (KDL), distributed by the Orocos Project. It is a meta-package that depends on kdl which contains the c++ version and pykdl which contains the generated python bindings.
This package depends on a recent version of the Kinematics and Dynamics Library (KDL), distributed by the Orocos Project. It is a meta-package that depends on kdl which contains the c++ version and pykdl which contains the generated python bindings.
 
2 2019-03-04 orocos_kdl
This package contains a recent version of the Kinematics and Dynamics Library (KDL), distributed by the Orocos Project.
This package contains a recent version of the Kinematics and Dynamics Library (KDL), distributed by the Orocos Project.
 
1 2017-11-01 orne_maps
orne_maps provides sharing maps for Tsukuba Challenge under Project ORNE.
orne_maps provides sharing maps for Tsukuba Challenge under Project ORNE.
 
1 2015-06-26 orientus_sdk_c
The Orientus C SDK
The Orientus C SDK
 
1 2015-06-26 orientus_driver
Driver for Orientus IMU
Driver for Orientus IMU
 
1 2015-12-08 or_nodes
or_nodes
or_nodes
 
1 2015-12-08 or_msgs
or_msgs
or_msgs
 
1 2015-12-08 or_libs
or_libs
or_libs
 
1 2019-05-23 opt_camera
opt_camera
opt_camera
 
1 2018-09-12 opensplice_dds_broker
opensplice dds comm broker package.
opensplice dds comm broker package.
 
1 2016-04-23 openslam_gmapping
ROS-ified version of gmapping SLAM. Forked from https://openslam.informatik.uni-freiburg.de/data/svn/gmapping/trunk/
ROS-ified version of gmapping SLAM. Forked from https://openslam.informatik.uni-freiburg.de/data/svn/gmapping/trunk/
 
1 2018-11-16 openrtm_tools
The openrtm_tools package
The openrtm_tools package
 
1 2018-11-16 openrtm_ros_bridge
openrtm_ros_bridge package provides basic functionalities to bind two robotics framework:
openrtm_ros_bridge package provides basic functionalities to bind two robotics framework:
 
1 2015-02-13 openrtm_aist
 
1 2017-02-03 openraveros_tutorials
There are two ways to start the server.
There are two ways to start the server.
 
1 2017-02-03 openrave_sensors
Contains openrave plugins that connect send and recieve ROS messages allowing OpenRAVE to communicate with the ROS world better.
Contains openrave plugins that connect send and recieve ROS messages allowing OpenRAVE to communicate with the ROS world better.
 
1 2017-02-03 openrave_robot_filter
Utilities for filtering the robot out of sensor data
Utilities for filtering the robot out of sensor data
 
1 2017-02-03 openrave_robot_control
Contains messages, services, and OpenRAVE clients to interface to robot hardware. - librobot_control - openrave plugin for ros client to talk to robot services - openravecontroller.h - base class for robot server using services - tfsender - given joint positions of the robot, sends the correct tf frames For more information on how to use this inside the openrave framework, see: http://openrave.programmingvision.com/wiki/index.php/ROS:ControllingRobots
Contains messages, services, and OpenRAVE clients to interface to robot hardware. - librobot_control - openrave plugin for ros client to talk to robot services - openravecontroller.h - base class for robot server using services - tfsender - given joint positions of the robot, sends the correct tf frames For more information on how to use this inside the openrave framework, see: http://openrave.programmingvision.com/wiki/index.php/ROS:ControllingRobots
 
1 2017-02-03 openrave_planning
This stack offers OpenRAVE-related bindings. Maintained by the JSK lab at University of Tokyo.
This stack offers OpenRAVE-related bindings. Maintained by the JSK lab at University of Tokyo.
 
1 2017-02-03 openrave_msgs
Contains ROS messages and services that are commonly used in the openrave_planning stack.
Contains ROS messages and services that are commonly used in the openrave_planning stack.
 
1 2017-02-03 openrave_database
Uses ROS to parallelize the database generation processes inside OpenRAVE.
Uses ROS to parallelize the database generation processes inside OpenRAVE.
 
1 2017-02-03 openrave_calibration
Package uses openrave planning and the robot_calibration stacks to calibrate a robot's sensors. The calibration only depends on the openrave/collada descriptions, therefore it is meant to be a relatively simple way of calibrating new robots with one-click.
Package uses openrave planning and the robot_calibration stacks to calibrate a robot's sensors. The calibration only depends on the openrave/collada descriptions, therefore it is meant to be a relatively simple way of calibrating new robots with one-click.
 
1 2017-02-03 openrave_actionlib
Bindings between openrave's controller interface and ROS's action lib interface for controlling robots.
Bindings between openrave's controller interface and ROS's action lib interface for controlling robots.
 
1 2017-02-03 openrave
In order to use, please add the following line in your bashrc:
In order to use, please add the following line in your bashrc:
 
1 2018-09-13 openni_description
Model files of OpenNI device.
Model files of OpenNI device.
 
1 2018-09-13 openni_camera
A ROS driver for OpenNI depth (+ RGB) cameras. These include: Microsoft Kinect, PrimeSense PSDK, ASUS Xtion Pro and Pro Live The driver publishes raw depth, RGB, and IR image streams.
A ROS driver for OpenNI depth (+ RGB) cameras. These include: Microsoft Kinect, PrimeSense PSDK, ASUS Xtion Pro and Pro Live The driver publishes raw depth, RGB, and IR image streams.
 
1 2018-12-01 openni2_camera
Drivers for the Asus Xtion and Primesense Devices. For using a kinect with ROS, try the
Drivers for the Asus Xtion and Primesense Devices. For using a kinect with ROS, try the
 

Packages

Name Description
1 2015-04-19 fanuc_lrmate200ic_support
 
1 2015-04-19 fanuc_lrmate200ic_moveit_plugins
 
1 2015-04-19 fanuc_lrmate200ic_moveit_config
 
1 2015-04-19 fanuc_lrmate200ic5l_moveit_config
 
1 2015-04-19 fanuc_lrmate200ic5h_moveit_config
 
1 2015-04-19 fanuc_driver
 
1 2015-04-19 fanuc_assets
 
1 2015-04-19 fanuc
ROS-Industrial support for Fanuc manipulators (metapackage).
ROS-Industrial support for Fanuc manipulators (metapackage).
 
1 2015-03-01 face_detector
Face detection in images.
Face detection in images.
 
1 2015-07-02 explorer
The explorer package utilizes frontier based exploration for multi-robot systems. Beside frontier detection, coordinated and uncoordinated exploration strategies are available to select goal points. Coordinated exploration enhances robot distribution and reduces redundancy in exploration reducing exploration time.
The explorer package utilizes frontier based exploration for multi-robot systems. Beside frontier detection, coordinated and uncoordinated exploration strategies are available to select goal points. Coordinated exploration enhances robot distribution and reduces redundancy in exploration reducing exploration time.
 
1 2014-03-13 executive_smach
This metapackage depends on the SMACH library and ROS SMACH integration packages.
This metapackage depends on the SMACH library and ROS SMACH integration packages.
 
1 2015-08-31 euslisp
EusLisp is an integrated programming system for the research on intelligent robots based on Common Lisp and Object-Oriented programming
EusLisp is an integrated programming system for the research on intelligent robots based on Common Lisp and Object-Oriented programming
 
1 2017-01-11 eusgazebo
The eusgazebo package
The eusgazebo 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 2016-02-26 ethzasl_point_cloud_vtk_tools
Tools to save point clouds to VTK files and to republish them
Tools to save point clouds to VTK files and to republish them
 
1 2016-02-26 ethzasl_icp_mapping
3d mapping tools for robotic applications
3d mapping tools for robotic applications
 
1 2016-02-26 ethzasl_icp_mapper_experiments
Utilities to do experiments using 3D point cloud matcher based on libpointmatcher (http://github.com/ethz-asl/libpointmatcher)
Utilities to do experiments using 3D point cloud matcher based on libpointmatcher (http://github.com/ethz-asl/libpointmatcher)
 
1 2016-02-26 ethzasl_icp_mapper
2D/3D mapper based on libpointmatcher (http://github.com/ethz-asl/libpointmatcher)
2D/3D mapper based on libpointmatcher (http://github.com/ethz-asl/libpointmatcher)
 
1 2016-02-26 ethzasl_gridmap_2d
Two-dimensional grid map with support for ray-tracing. Somehow similar to costmap_2d but also provides getters at sub-pixel precision, morphological operations, fast gradient-propagation algorithm as well as support for multiple grids per resize group.
Two-dimensional grid map with support for ray-tracing. Somehow similar to costmap_2d but also provides getters at sub-pixel precision, morphological operations, fast gradient-propagation algorithm as well as support for multiple grids per resize group.
 
1 2016-02-26 ethzasl_extrinsic_calibration
Calibration of 3D transform of a depth sensor given two sets of TFs, one from the odometry and one from the sensor pose.
Calibration of 3D transform of a depth sensor given two sets of TFs, one from the odometry and one from the sensor pose.
 
1 2014-08-11 epos_driver
ROS driver for EPOS controller
ROS driver for EPOS controller
 
1 2014-05-07 enu
enu
enu
 
1 2013-08-29 eigen_utils
Useful math functions using Eigen
Useful math functions using Eigen
 
1 2015-02-05 eigen_typekit
An Orocos typekit for Eigen types.
An Orocos typekit for Eigen types.
 
1 2017-03-28 eigen_stl_containers
This package provides a set of typedef's that allow using Eigen datatypes in STL containers
This package provides a set of typedef's that allow using Eigen datatypes in STL containers
 
1 2015-05-12 eigen_conversions
Conversion functions between: - Eigen and KDL - Eigen and geometry_msgs.
Conversion functions between: - Eigen and KDL - Eigen and geometry_msgs.
 
1 2014-10-28 effort_controllers
effort_controllers
effort_controllers
 
1 2016-08-25 ecto_ros
A set of generic cells to interact with ROS
A set of generic cells to interact with ROS
 
1 2016-08-25 ecto_pcl
Ecto bindings for common PCL functionality.
Ecto bindings for common PCL functionality.
 
1 2015-05-09 ecto_openni
Ecto bindings for the openni sensor.
Ecto bindings for the openni sensor.
 
1 2017-11-12 ecto_opencv
Ecto bindings for common opencv functionality.
Ecto bindings for common opencv functionality.
 
1 2016-04-24 ecto_image_pipeline
Common tools for image based pipelines. Includes stereo and mono camera drivers, rectification, image sinks, calibration, etc..
Common tools for image based pipelines. Includes stereo and mono camera drivers, rectification, image sinks, calibration, etc..
 
1 2018-05-14 ecto
Ecto is a hybrid C++/Python development framework for constructing and maintaining pipelines.
Ecto is a hybrid C++/Python development framework for constructing and maintaining pipelines.
 
1 2015-07-11 easy_markers
Python library to assist in publishing markers easily
Python library to assist in publishing markers easily
 
1 2018-02-02 dynpick_driver
Driver package for Wacohtech dynpick force sensor. This contains
Driver package for Wacohtech dynpick force sensor. This contains
 
1 2017-02-20 dynamixel_tutorials
Example configuration and launch file for dynamixel_motor stack.
Example configuration and launch file for dynamixel_motor stack.
 
1 2013-08-20 dynamixel_pro_moveit_controller
The dynamixel_pro_moveit_controller package, it interprets joint trajectories and uses the low level drivers to directly control the arm. Avoiding the extra layer of translating the joint_trajectory messages to joint_state messages
The dynamixel_pro_moveit_controller package, it interprets joint trajectories and uses the low level drivers to directly control the arm. Avoiding the extra layer of translating the joint_trajectory messages to joint_state messages
 
1 2013-10-04 dynamixel_pro_driver
The dynamixel_pro_driver package
The dynamixel_pro_driver package
 
1 2014-03-28 dynamixel_pro_controller
The dynamixel_pro_controller package
The dynamixel_pro_controller package
 
1 2013-08-20 dynamixel_pro_arm_moveit_config
An automatically generated package with all the configuration and launch files for using the dynamixel_pro_arm with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the dynamixel_pro_arm with the MoveIt Motion Planning Framework
 
1 2013-08-20 dynamixel_pro_arm_description
The dynamixel_pro_arm_description package contains an URDF model of the dynamixel pro arm
The dynamixel_pro_arm_description package contains an URDF model of the dynamixel pro arm
 
1 2013-08-20 dynamixel_pro_arm
The dynamixel_pro_arm package
The dynamixel_pro_arm package
 
1 2017-02-20 dynamixel_msgs
Common messages used throughout dynamixel_motor stack.
Common messages used throughout dynamixel_motor stack.
 
1 2017-02-20 dynamixel_motor
This stack contains packages that are used to interface with Robotis Dynamixel line of servo motors. This stack was tested with and fully supports AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, MX-64, EX-106 and MX-106 models.
This stack contains packages that are used to interface with Robotis Dynamixel line of servo motors. This stack was tested with and fully supports AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, MX-64, EX-106 and MX-106 models.
 
1 2017-02-20 dynamixel_driver
This package provides low level IO for Robotis Dynamixel servos. Fully supports and was tested with AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, EX-106 models. Hardware specific constants are defined for reading and writing information from/to Dynamixel servos. This low level package won't be used directly by most ROS users. The higher level dynamixel_controllers and specific robot joint controllers make use of this package.
This package provides low level IO for Robotis Dynamixel servos. Fully supports and was tested with AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, EX-106 models. Hardware specific constants are defined for reading and writing information from/to Dynamixel servos. This low level package won't be used directly by most ROS users. The higher level dynamixel_controllers and specific robot joint controllers make use of this package.
 
1 2017-02-20 dynamixel_controllers
This package contains a configurable node, services and a spawner script to start, stop and restart one or more controller plugins. Reusable controller types are defined for common Dynamixel motor joints. Both speed and torque can be set for each joint. This python package can be used by more specific robot controllers and all configurable parameters can be loaded via a yaml file.
This package contains a configurable node, services and a spawner script to start, stop and restart one or more controller plugins. Reusable controller types are defined for common Dynamixel motor joints. Both speed and torque can be set for each joint. This python package can be used by more specific robot controllers and all configurable parameters can be loaded via a yaml file.
 
1 2019-05-22 dynamic_tf_publisher
dynamically set the tf trensformation
dynamically set the tf trensformation
 
1 2018-10-02 dynamic_reconfigure
This unary stack contains the dynamic_reconfigure package which provides a means to change node parameters at any time without having to restart the node.
This unary stack contains the dynamic_reconfigure package which provides a means to change node parameters at any time without having to restart the node.