Packages

Name Description
0 snap_map_icp
1 smp_ros
1 smarthome_network_zeroconf
1 smarthome_network_wakeonlan
1 smarthome_msgs_java
1 smarthome_msgs
1 smarthome_media_samsungtv_driver
1 smarthome_media_onkyo_driver
1 smarthome_media_msgs_java
1 smarthome_media_msgs
1 smarthome_media_model
1 smarthome_media_kodi_driver
1 smarthome_light_msgs_java
1 smarthome_light_msgs
1 smarthome_heater_msgs_java
1 smarthome_heater_msgs
1 smarthome_common_driver
1 smarthome_comm_msgs_java
1 smarthome_comm_msgs
1 smartek_camera
1 smart_battery_msgs
1 slider_gui
1 slam_gmapping
2 slam_exporter
1 slam_constructor
1 slam6d_exporter
1 skeleton_markers
1 simple_voice
1 simple_robot_control
1 simple_navigation_goals_tutorial
0 simple_grasping_action
1 simple_drive
1 simple_arm
1 simple_approximate_time_synchronizer
1 siftgpu
1 siemens_cp1616
1 sicktoolbox_wrapper
1 sicktoolbox
1 sick_visionary_t_driver
1 sick_visionary_t
1 2019-05-06 sick_ldmrs_tools
Examples how to use the sick_ldmrs
Examples how to use the sick_ldmrs
 
1 2019-05-06 sick_ldmrs_msgs
Messages and PCL point types for SICK LD-MRS.
Messages and PCL point types for SICK LD-MRS.
 
1 2019-05-06 sick_ldmrs_laser
A ROS driver for the SICK LD-MRS series of laser scanners.
A ROS driver for the SICK LD-MRS series of laser scanners.
 
1 2019-05-06 sick_ldmrs_driver
A ROS driver for the SICK LD-MRS series of laser scanners.
A ROS driver for the SICK LD-MRS series of laser scanners.
 
1 2019-05-06 sick_ldmrs_description
This package contains an URDF description of the SICK LD-MRS scanner and all supporting mesh files.
This package contains an URDF description of the SICK LD-MRS scanner and all supporting mesh files.
 
1 shm_transport
0 sherlock_sim_msgs
1 shared_serial
1 shared_queues_vendor
0 shared_memory_transport

Packages

Name Description
1 2017-06-26 ecl_linear_algebra
Ecl frontend to a linear matrix package (currently eigen).
Ecl frontend to a linear matrix package (currently eigen).
 
1 2017-02-05 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 2017-06-26 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 2017-06-26 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 2017-06-26 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 2017-06-26 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 2017-06-26 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 2017-06-26 ecl_eigen
This provides an Eigen implementation for ecl's linear algebra.
This provides an Eigen implementation for ecl's linear algebra.
 
1 2017-06-26 ecl_devices
Provides an extensible and standardised framework for input-output devices.
Provides an extensible and standardised framework for input-output devices.
 
1 2017-06-26 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 2017-06-26 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 2017-06-26 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 2017-06-26 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 2017-06-26 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 2017-06-26 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-02-05 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
 
2 2017-11-22 eband_local_planner
eband_local_planner implements a plugin to the base_local_planner. It implements the Elastic Band method on the SE2 manifold.
eband_local_planner implements a plugin to the base_local_planner. It implements the Elastic Band method on the SE2 manifold.
 
1 2016-07-23 easy_markers
Python library to assist in publishing markers easily
Python library to assist in publishing markers easily
 
1 2019-02-08 earth_rover_piksi
Meta-package for the earth_rover_piksi repository.
Meta-package for the earth_rover_piksi repository.
 
1 2019-03-07 earth_rover_localization
Configuration for the EKF of the robot_localization package to use with the Earth Rover Open Agribot.
Configuration for the EKF of the robot_localization package to use with the Earth Rover Open Agribot.
 
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 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
 
1 2019-01-03 dynamixel_workbench_single_manager
This package is single manager for a Dynamixel. It provides a terminal environment to check the status of Dynamixel and control it before using Dynamixel
This package is single manager for a Dynamixel. It provides a terminal environment to check the status of Dynamixel and control it before using Dynamixel
 
1 2019-01-03 dynamixel_workbench_operators
This package contains nodes that control the Dynamixel by communicating with the server registered in the 'dynamixel_workbench_controllers' package
This package contains nodes that control the Dynamixel by communicating with the server registered in the 'dynamixel_workbench_controllers' package
 
1 2019-01-03 dynamixel_workbench_msgs
This package includes ROS messages and services for dynamixel_workbench packages
This package includes ROS messages and services for dynamixel_workbench packages
 
1 2019-01-03 dynamixel_workbench_controllers
This package contains examples of applying the 'dynamixel_workbench_toolbox' library developed on the basis of dynamixel_sdk to various operating modes of Dynamixel.
This package contains examples of applying the 'dynamixel_workbench_toolbox' library developed on the basis of dynamixel_sdk to various operating modes of Dynamixel.
 
1 2019-01-03 dynamixel_workbench
Dynamixel-Workbench is dynamixel solution for ROS. This metapackage allows you to easily change the ID, baudrate and operating mode of the Dynamixel. Furthermore, it supports various controllers based on operating mode and Dynamixel SDK. These controllers are commanded by operators.
Dynamixel-Workbench is dynamixel solution for ROS. This metapackage allows you to easily change the ID, baudrate and operating mode of the Dynamixel. Furthermore, it supports various controllers based on operating mode and Dynamixel SDK. These controllers are commanded by operators.
 
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 2019-01-02 dynamixel_sdk
This package is wrapping version of ROBOTIS Dynamxel SDK for ROS. The ROBOTIS Dynamixel SDK, or SDK, is a software development library that provides Dynamixel control functions for packet communication. The API is designed for Dynamixel actuators and Dynamixel-based platforms.
This package is wrapping version of ROBOTIS Dynamxel SDK for ROS. The ROBOTIS Dynamixel SDK, or SDK, is a software development library that provides Dynamixel control functions for packet communication. The API is designed for Dynamixel actuators and Dynamixel-based platforms.
 
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 2019-03-17 dynamic_robot_state_publisher
Improved ROS robot_state_publisher which can update the robot model via dynamic_reconfigure.
Improved ROS robot_state_publisher which can update the robot model via dynamic_reconfigure.
 
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.
 
1 2018-11-01 dynamic_edt_3d
The dynamicEDT3D library implements an inrementally updatable Euclidean distance transform (EDT) in 3D. It comes with a wrapper to use the OctoMap 3D representation and hooks into the change detection of the OctoMap library to propagate changes to the EDT.
The dynamicEDT3D library implements an inrementally updatable Euclidean distance transform (EDT) in 3D. It comes with a wrapper to use the OctoMap 3D representation and hooks into the change detection of the OctoMap library to propagate changes to the EDT.
 
2 2019-05-24 dwb_plugins
Standard implementations of the GoalChecker and TrajectoryGenerators for dwb_local_planner
Standard implementations of the GoalChecker and TrajectoryGenerators for dwb_local_planner
 
2 2019-05-24 dwb_msgs
Message/Service definitions specifically for the dwb_local_planner
Message/Service definitions specifically for the dwb_local_planner
 
1 2019-05-24 dwb_local_planner
Plugin based local planner implementing the nav_core2::LocalPlanner interface.
Plugin based local planner implementing the nav_core2::LocalPlanner interface.
 

Packages

Name Description
1 2016-11-22 fiducial_pose
ROS node to estimate 3D pose with RosbustPlanarPose
ROS node to estimate 3D pose with RosbustPlanarPose
 
1 2016-11-22 fiducial_lib
The fiducials package
The fiducials package
 
1 2016-11-22 fiducial_detect
The fiducials_ros package
The fiducials_ros package
 
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-03-28 fetchit_challenge
The fetchit_challenge package
The fetchit_challenge package
 
1 2019-05-23 fetcheus
The fetcheus package
The fetcheus package
 
1 2018-07-11 fetch_tools
Commands for performing common operations when developing on the robots. For help, run `fetch -h` and `fetch COMMAND -h`.
Commands for performing common operations when developing on the robots. For help, run `fetch -h` and `fetch COMMAND -h`.
 
1 2019-04-26 fetch_teleop
Teleoperation for fetch and freight.
Teleoperation for fetch and freight.
 
1 2017-08-08 fetch_social_gaze
The fetch_social_gaze package
The fetch_social_gaze package
 
1 2019-03-28 fetch_simulation
Fetch Simulation, packages for working with Fetch and Freight in Gazebo
Fetch Simulation, packages for working with Fetch and Freight in Gazebo
 
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 2017-08-08 fetch_pbd_interaction
The fetch_pbd_interaction package
The fetch_pbd_interaction package
 
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-03-28 fetch_gazebo_demo
Demos for fetch_gazebo package.
Demos for fetch_gazebo package.
 
1 2019-03-28 fetch_gazebo
Gazebo package for Fetch.
Gazebo package for Fetch.
 
1 2018-07-10 fetch_driver_msgs
Messages for the fetch_drivers package
Messages for the fetch_drivers package
 
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 2018-07-10 fetch_auto_dock_msgs
Messages for fetch_auto_dock package
Messages for fetch_auto_dock package
 
1 2017-08-08 fetch_arm_control
The fetch_arm_control package
The fetch_arm_control package
 
1 2015-02-23 featurenav_base
The featurenav_base package provides base functionality for learning and navigating jockeys based on feature detection for the Large Maps Framework (LaMa).
The featurenav_base package provides base functionality for learning and navigating jockeys based on feature detection for the Large Maps Framework (LaMa).
 
1 2019-04-26 fcl
FCL is a collision checking library
FCL is a collision checking library
 
1 2019-04-18 fanuc_resources
 
2 2019-04-18 fanuc_r1000ia_support
 
2 2019-04-18 fanuc_r1000ia_moveit_plugins
 
2 2019-04-18 fanuc_r1000ia80f_moveit_config
 
2 2019-04-18 fanuc_m900ib_support
 
2 2019-04-18 fanuc_m900ia_support
 
2 2019-04-18 fanuc_m710ic_support
 
1 2019-04-18 fanuc_m6ib_support
 
1 2019-04-18 fanuc_m6ib_moveit_plugins
 
1 2019-04-18 fanuc_m6ib_moveit_config
 
1 2019-04-18 fanuc_m430ia_support
 
1 2019-04-18 fanuc_m430ia_moveit_plugins
 
1 2019-04-18 fanuc_m430ia2p_moveit_config
 
1 2019-04-18 fanuc_m430ia2f_moveit_config
 
1 2019-04-18 fanuc_m20ia_support
 
1 2019-04-18 fanuc_m20ia_moveit_plugins
 
1 2019-04-18 fanuc_m20ia_moveit_config
 
1 2019-04-18 fanuc_m20ia10l_moveit_config
 
1 2019-04-18 fanuc_m16ib_support
 
1 2019-04-18 fanuc_m16ib_moveit_plugins
 
1 2019-04-18 fanuc_m16ib20_moveit_config
 
1 2019-04-18 fanuc_m10ia_support
 
1 2019-04-18 fanuc_m10ia_moveit_plugins
 

Packages

Name Description
1 rviz2
1 rv7fl_moveit_config
1 rv4fl_moveit_config
1 rttest
1 rtt_typelib
1 rtt_tf2_msgs
1 rtt_rosparam_tests
1 rtt_controller_manager_msgs
1 rtt_control_msgs
2 rtt_conman_msgs
1 2015-04-22 rtshell
 
1 rtmros_nextage
1 rtmros_hironx
2 2015-04-22 rtctree
 
1 2016-07-19 rsync_ros
An actionlib interface for Rsync
An actionlib interface for Rsync
 
1 2015-10-28 rsv_balance_viz
RVIZ configurations and custom visualizations.
RVIZ configurations and custom visualizations.
 
1 2017-10-09 rsv_balance_simulator
Simulation packages for RoboSavvy's balancing platform.
Simulation packages for RoboSavvy's balancing platform.
 
1 2015-10-28 rsv_balance_rqt
RQT interface for setting operation mode of the balance platform.
RQT interface for setting operation mode of the balance platform.
 
1 2015-10-30 rsv_balance_msgs
RoboSavvy's balancing platform messages and services definitions.
RoboSavvy's balancing platform messages and services definitions.
 
1 2017-10-09 rsv_balance_gazebo_control
Self-balancing control implementation package: currently simple PID demo.
Self-balancing control implementation package: currently simple PID demo.
 
1 2017-10-09 rsv_balance_gazebo
Gazebo's specific packages for RoboSavvy's balance platform.
Gazebo's specific packages for RoboSavvy's balance platform.
 
1 2015-10-28 rsv_balance_desktop
Visualization and HMI packages for RoboSavvy's balancing platform
Visualization and HMI packages for RoboSavvy's balancing platform
 
1 2015-10-30 rsv_balance_description
RoboSavvy's balancing platform URDF description and meshes.
RoboSavvy's balancing platform URDF description and meshes.
 
1 2015-10-30 rsv_balance
Common packages for RoboSavvy's balancing platform
Common packages for RoboSavvy's balancing platform
 
1 rslidar_pointcloud
1 rslidar_msgs
1 rslidar_driver
1 rslidar
1 rrt_exploration
1 rr_swiftnav_piksi
1 rr_openrover_basic
1 rqt_wrapper
1 2016-08-12 rqt_video_playback
The rqt_video_playback package
The rqt_video_playback package
 
1 rqt_rosmon
1 rqt_py_trees
1 rqt_pr2_dashboard
1 rqt_paramedit
1 rqt_mrta
1 rqt_joint_trajectory_plot
1 rqt_graphprofiler
1 rqt_dyn_tune
0 rqt_dot
1 rqt_decision_graph
2 rqt_conman
1 rqt_capabilities
1 rqt_bhand
1 rqt_bag_exporter
1 rqt_arni_gui_overview
1 rqt_arni_gui_detail
1 rqt_alliance

Packages

Name Description
1 2016-02-09 summit_xl_localization
The summit_xl_localization package
The summit_xl_localization package
 
1 2014-12-04 summit_xl_joystick
The summit_xl_joystick package allows to control the summit_xl product range (summit_xl, summit_xl_omni, x_wam) teleoperation in simualtion
The summit_xl_joystick package allows to control the summit_xl product range (summit_xl, summit_xl_omni, x_wam) teleoperation in simualtion
 
1 2014-12-04 summit_xl_joint_state
The summit_xl_joint_state package is a simple template for a joint_state publisher node
The summit_xl_joint_state package is a simple template for a joint_state publisher node
 
1 2014-12-04 summit_xl_gazebo
summit_xl_gazebo
summit_xl_gazebo
 
2 2014-12-04 summit_xl_description
This package includes the urdf, sdf, and meshes for the kinematic description of the summit_xl product range : summit_xl summit_xl_omni and x_wam
This package includes the urdf, sdf, and meshes for the kinematic description of the summit_xl product range : summit_xl summit_xl_omni and x_wam
 
2 2014-12-04 summit_xl_control
The summit_xl_control package
The summit_xl_control package
 
1 2016-02-09 summit_xl_common
URDF description of the Summit XL and Summit XL HL, platform messages and other files for simulation.
URDF description of the Summit XL and Summit XL HL, platform messages and other files for simulation.
 
1 2014-12-04 summit_xl_2dnav
This package configures the move_base stack and makes use of the gmapping and amcl algorithms to move the summit_xl robot
This package configures the move_base stack and makes use of the gmapping and amcl algorithms to move the summit_xl robot
 
1 summit_x_sim_bringup
1 summit_x_sim
1 summit_x_robot_control
1 summit_x_gazebo
1 summit_x_description
1 summit_x_control
1 summit_x_common
1 stream_manipulator_3d
1 straf_recovery
1 stop_base
1 stomp_test_support
1 stomp_test_kr210_moveit_config
2 stomp_plugins
2 stomp_moveit
2 stomp_core
1 stereo_slam
1 stepback_and_steerturn_recovery
1 steer_drive_ros
1 steer_drive_controller
1 steer_bot_hardware_gazebo
0 std_srv
1 staubli_val3_driver
1 staubli_tx90_support
1 staubli_tx90_gazebo
1 staubli_tx60_support
1 staubli_tx60_gazebo
1 2015-08-04 staubli_rx160_support
 
1 2015-08-04 staubli_rx160_moveit_plugins
 
1 2015-08-04 staubli_rx160_moveit_config
 
1 staubli_rx160_gazebo
1 2015-08-04 staubli_resources
 
1 2014-08-28 staubli_experimental
Experimental packages for Staubli manipulators within ROS-Industrial (metapackage).
Experimental packages for Staubli manipulators within ROS-Industrial (metapackage).
 
1 2015-08-04 staubli
ROS-Industrial support for Staubli manipulators (metapackage).
ROS-Industrial support for Staubli manipulators (metapackage).
 
1 static_transform_mux
1 static_tf
1 stand_alone_gui
1 stage_ros
1 2015-02-05 srv_tools
Stack with interesting ROS tools
Stack with interesting ROS tools
 
1 sros2_cmake
1 sros2
1 srdfdom
0 srdf