Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | enu | ||||
| 1 | ensenso_driver | ||||
| 1 | ensenso_description | ||||
| 1 | ensenso_camera_test | ||||
| 1 | ensenso_camera_msgs | ||||
| 1 | ensenso_camera | ||||
| 1 | ensenso | ||||
| 0 | eml | ||||
| 1 | elevator_move_base_pr2 | ||||
| 1 | elevator | ||||
| 1 | ekf_localization | ||||
| 1 | eigenpy | ||||
| 1 | eigen_utils | ||||
| 1 | eigen_typekit | ||||
| 1 | 2019-02-11 | 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 | eigen_conversions | ||||
| 1 | effort_controllers | ||||
| 0 | ee_cart_imped_msgs | ||||
| 0 | ee_cart_imped_jsk_patch | ||||
| 0 | ee_cart_imped_control | ||||
| 0 | ee_cart_imped_action | ||||
| 1 | ecto_ros | ||||
| 1 | ecto_pcl | ||||
| 1 | ecto_openni | ||||
| 1 | ecto_opencv | ||||
| 1 | ecto_image_pipeline | ||||
| 1 | ecto | ||||
| 1 | 2018-12-31 | ecl_utilities |
Includes various supporting tools and utilities for c++ programming.
Includes various supporting tools and utilities for c++ programming.
|
||
| 1 | 2018-12-31 | 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 | 2018-12-31 | ecl_tools |
Tools and utilities for ecl development.
Tools and utilities for ecl development.
|
||
| 1 | 2018-12-31 | 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-12-31 | 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-12-31 | 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-12-31 | 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-12-31 | ecl_statistics |
Common statistical structures and algorithms for control systems.
Common statistical structures and algorithms for control systems.
|
||
| 1 | 2018-12-31 | 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-12-31 | 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 | ecl_navigation | ||||
| 1 | 2018-12-31 | 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 | 2018-12-31 | 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-12-31 | 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-12-31 | ecl_manipulators |
Deploys various manipulation algorithms, currently just
feedforward filters (interpolations).
Deploys various manipulation algorithms, currently just
feedforward filters (interpolations).
|
||
| 1 | ecl_manipulation | ||||
| 1 | 2018-12-31 | ecl_lite |
Libraries and utilities for embedded and low-level linux development.
Libraries and utilities for embedded and low-level linux development.
|
||
| 1 | 2018-12-31 | ecl_linear_algebra |
Ecl frontend to a linear matrix package (currently eigen).
Ecl frontend to a linear matrix package (currently eigen).
|
||
| 1 | 2018-12-31 | 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-12-31 | 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 | 2018-12-31 | 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-12-31 | 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-12-31 | 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).
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | ensenso_camera_msgs | ||||
| 1 | ensenso_camera | ||||
| 1 | ensenso | ||||
| 0 | eml | ||||
| 1 | elevator_move_base_pr2 | ||||
| 1 | elevator | ||||
| 1 | ekf_localization | ||||
| 1 | eigenpy | ||||
| 1 | eigen_utils | ||||
| 1 | eigen_typekit | ||||
| 1 | eigen_stl_containers | ||||
| 1 | eigen_conversions | ||||
| 1 | effort_controllers | ||||
| 0 | ee_cart_imped_msgs | ||||
| 0 | ee_cart_imped_jsk_patch | ||||
| 0 | ee_cart_imped_control | ||||
| 0 | ee_cart_imped_action | ||||
| 1 | ecto_ros | ||||
| 1 | ecto_pcl | ||||
| 1 | ecto_openni | ||||
| 1 | ecto_opencv | ||||
| 1 | ecto_image_pipeline | ||||
| 1 | ecto | ||||
| 1 | 2018-09-27 | ecl_utilities |
Includes various supporting tools and utilities for c++ programming.
Includes various supporting tools and utilities for c++ programming.
|
||
| 1 | 2018-09-27 | 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 | 2018-09-26 | ecl_tools |
Tools and utilities for ecl development.
Tools and utilities for ecl development.
|
||
| 1 | 2018-09-27 | 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-27 | 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-27 | 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-27 | 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-27 | ecl_statistics |
Common statistical structures and algorithms for control systems.
Common statistical structures and algorithms for control systems.
|
||
| 1 | 2018-09-27 | 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-27 | 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 | ecl_navigation | ||||
| 1 | 2018-09-27 | 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 | 2018-09-27 | 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-27 | 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-27 | ecl_manipulators |
Deploys various manipulation algorithms, currently just
feedforward filters (interpolations).
Deploys various manipulation algorithms, currently just
feedforward filters (interpolations).
|
||
| 1 | ecl_manipulation | ||||
| 1 | 2018-09-27 | 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-27 | ecl_linear_algebra |
Ecl frontend to a linear matrix package (currently eigen).
Ecl frontend to a linear matrix package (currently eigen).
|
||
| 1 | 2018-09-26 | 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-27 | 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 | 2018-09-27 | 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-27 | 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-27 | 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-27 | 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-27 | 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 | 2018-09-27 | 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-27 | ecl_eigen |
This provides an Eigen implementation for ecl's linear algebra.
This provides an Eigen implementation for ecl's linear algebra.
|
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | evarobot_pose_ekf | ||||
| 1 | evarobot_navigation | ||||
| 1 | evarobot_gazebo | ||||
| 1 | evarobot_diagnostics | ||||
| 1 | evarobot_description | ||||
| 1 | evarobot_competition | ||||
| 1 | evapc_start | ||||
| 1 | evapc_ros | ||||
| 1 | 2018-12-05 | euslisp_model_conversion_tester |
euslisp_model_conversion_tester
euslisp_model_conversion_tester
|
||
| 1 | eusgazebo | ||||
| 1 | 2018-12-05 | euscollada |
euscollada
euscollada
|
||
| 1 | eus_qpoases | ||||
| 1 | eus_qp | ||||
| 1 | eus_nlopt | ||||
| 2 | 2018-12-05 | eus_assimp |
eus_assimp
eus_assimp
|
||
| 1 | ethzasl_point_cloud_vtk_tools | ||||
| 1 | ethzasl_icp_mapping | ||||
| 1 | ethzasl_icp_mapper_experiments | ||||
| 1 | ethzasl_icp_mapper | ||||
| 1 | ethzasl_gridmap_2d | ||||
| 1 | ethzasl_extrinsic_calibration | ||||
| 2 | 2018-09-20 | ethercat_trigger_controllers |
Controllers to operate the digital output of the motor controller
boards and the projector board. This package has not been reviewed and
should be considered unstable.
Controllers to operate the digital output of the motor controller
boards and the projector board. This package has not been reviewed and
should be considered unstable.
|
||
| 1 | ethercat_soem | ||||
| 1 | ethercat_manager | ||||
| 3 | 2019-03-12 | ethercat_hardware |
Package for creating a hardware interface to the robot using the EtherCAT motor controller/driver
Package for creating a hardware interface to the robot using the EtherCAT motor controller/driver
|
||
| 1 | ethercat_grant | ||||
| 0 | etherbotix_python | ||||
| 1 | erratic_teleop | ||||
| 1 | erratic_player | ||||
| 1 | erratic_navigation_apps | ||||
| 1 | erratic_navigation | ||||
| 1 | erratic_gazebo_plugins | ||||
| 1 | erratic_description | ||||
| 1 | epuck_driver | ||||
| 1 | epson_g364_imu_driver | ||||
| 1 | epos_library | ||||
| 1 | epos_hardware | ||||
| 1 | epos_driver | ||||
| 1 | epos2_motor_controller | ||||
| 1 | enu | ||||
| 1 | 2019-05-10 | ensenso_driver |
Driver for Ensenso stereo cameras.
Driver for Ensenso stereo cameras.
|
||
| 1 | 2019-05-10 | ensenso_description |
Description package for Ensenso stereo cameras. This package consists of all current supported camera models.
The Xacro macros, which import the mesh files as stl, accept the following parameters:
- camera name
- parent frame and its transform regarding to the camera mounting frame
- collision margin to the camera
Description package for Ensenso stereo cameras. This package consists of all current supported camera models.
The Xacro macros, which import the mesh files as stl, accept the following parameters:
- camera name
- parent frame and its transform regarding to the camera mounting frame
- collision margin to the camera
|
||
| 1 | 2019-05-10 | ensenso_camera_test |
Tests for the ensenso_camera package.
Tests for the ensenso_camera package.
|
||
| 1 | 2019-05-10 | ensenso_camera_msgs |
Message definitions for the ensenso_camera package.
Message definitions for the ensenso_camera package.
|
||
| 1 | 2019-05-10 | ensenso_camera |
Driver for Ensenso stereo cameras.
Driver for Ensenso stereo cameras.
|
||
| 0 | eml | ||||
| 1 | elevator_move_base_pr2 | ||||
| 1 | elevator | ||||
| 1 | ekf_localization | ||||
| 1 | eigenpy |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-01-10 | framefab_kr6_r900_support |
Support package for a framefab_mpp system using KUKA kr6_r900sixx.
Support package for a framefab_mpp system using KUKA kr6_r900sixx.
|
||
| 1 | 2019-01-10 | framefab_irb6600_workspace_moveit_config |
An automatically generated package with all the configuration and launch files for using the framefab_irb6600_workspace with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the framefab_irb6600_workspace with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-01-10 | framefab_irb6600_workspace_ikfast_rail_robot_manipulator_plugin |
The framefab_irb6600_workspace_ikfast_rail_robot_manipulator_plugin package
The framefab_irb6600_workspace_ikfast_rail_robot_manipulator_plugin package
|
||
| 1 | 2019-04-09 | frame_editor |
The frame_editor package
The frame_editor package
|
||
| 1 | foscam_8918_driver | ||||
| 1 | 2019-04-08 | forward_command_controller |
forward_command_controller
forward_command_controller
|
||
| 1 | forte_rc_teleop | ||||
| 1 | forte_rc_robot | ||||
| 1 | forte_rc_mapping_slam | ||||
| 1 | forte_rc_driver | ||||
| 1 | forte_rc_description | ||||
| 1 | forte_rc_cloud | ||||
| 1 | forte_rc_2dnav | ||||
| 1 | 2018-03-27 | force_torque_tools |
Tools for gravity compensation and force-torque sensor calibration.
Tools for gravity compensation and force-torque sensor calibration.
|
||
| 1 | 2019-04-08 | force_torque_sensor_controller |
Controller to publish state of force-torque sensors
Controller to publish state of force-torque sensors
|
||
| 1 | 2018-03-27 | force_torque_sensor_calib |
Calibrates the offsets of F/T sensors and the mass and position of the COM of gripper attached to the F/T sensor. Uses readings from an accelerometer that has been calibrated to the robot frame.
Calibrates the offsets of F/T sensors and the mass and position of the COM of gripper attached to the F/T sensor. Uses readings from an accelerometer that has been calibrated to the robot frame.
|
||
| 1 | force_sensor_handler | ||||
| 0 | force_proximity_ros | ||||
| 3 | 2018-04-18 | footstep_planner |
|
||
| 1 | 2017-08-04 | follow_waypoints |
The follow_waypoints node will listen for waypoints given as
poses and when instructed will follow them one by one by publishing goals
to move_base.
The follow_waypoints node will listen for waypoints given as
poses and when instructed will follow them one by one by publishing goals
to move_base.
|
||
| 1 | folaga_msgs | ||||
| 2 | fmi_adapter_examples | ||||
| 2 | fmi_adapter | ||||
| 1 | 2019-03-18 | flir_ptu_viz |
Launchfiles and rviz configs to assist with visualizing the FLIR PTUs.
Launchfiles and rviz configs to assist with visualizing the FLIR PTUs.
|
||
| 1 | 2019-03-18 | flir_ptu_driver |
Driver for the FLIR pan/tilt units.
Driver for the FLIR pan/tilt units.
|
||
| 1 | 2019-03-18 | flir_ptu_description |
URDF description the FLIR PTUs, currently the D46.
URDF description the FLIR PTUs, currently the D46.
|
||
| 1 | 2018-09-25 | flir_camera_driver |
A set of drivers for Flir cameras based on the Spinnaker SDK.
A set of drivers for Flir cameras based on the Spinnaker SDK.
|
||
| 1 | 2019-04-09 | flexbe_widget |
flexbe_widget implements some smaller scripts for the behavior engine.
flexbe_widget implements some smaller scripts for the behavior engine.
|
||
| 1 | 2019-04-09 | flexbe_testing |
flexbe_testing provides a framework for unit testing states.
flexbe_testing provides a framework for unit testing states.
|
||
| 1 | 2019-04-09 | flexbe_states |
flexbe_states provides a collection of predefined states.
Feel free to add new states.
flexbe_states provides a collection of predefined states.
Feel free to add new states.
|
||
| 1 | 2019-04-09 | flexbe_onboard |
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
|
||
| 1 | 2019-04-09 | flexbe_msgs |
flexbe_msgs provides the messages used by FlexBE.
flexbe_msgs provides the messages used by FlexBE.
|
||
| 1 | 2019-04-09 | flexbe_mirror |
flexbe_mirror implements functionality to remotely mirror an executed behavior.
flexbe_mirror implements functionality to remotely mirror an executed behavior.
|
||
| 1 | 2019-04-09 | flexbe_input |
flexbe_input enables to send data to onboard behavior when required.
flexbe_input enables to send data to onboard behavior when required.
|
||
| 1 | 2019-04-09 | flexbe_core |
flexbe_core provides the core smach extension for the FlexBE behavior engine.
flexbe_core provides the core smach extension for the FlexBE behavior engine.
|
||
| 1 | 2019-04-09 | flexbe_behavior_engine |
A meta-package to aggregate all the FlexBE packages
A meta-package to aggregate all the FlexBE packages
|
||
| 0 | flask_reverse_proxy | ||||
| 1 | flaky | ||||
| 1 | 2019-02-01 | fkie_potree_rviz_plugin |
Render large point clouds in rviz
Render large point clouds in rviz
|
||
| 1 | fkie_message_filters | ||||
| 1 | fiveam | ||||
| 1 | firos | ||||
| 3 | 2019-03-12 | fingertip_pressure |
This package provides access to the PR2 fingertip pressure sensors. This information includes:
This package provides access to the PR2 fingertip pressure sensors. This information includes:
|
||
| 1 | 2017-03-16 | filters |
This library provides a standardized interface for processing data as a sequence
of filters. This package contains a base class upon which to build specific implementations
as well as an interface which dynamically loads filters based on runtime parameters.
This library provides a standardized interface for processing data as a sequence
of filters. This package contains a base class upon which to build specific implementations
as well as an interface which dynamically loads filters based on runtime parameters.
|
||
| 1 | 2019-05-09 | fiducials |
Localization using fiducial markers
Localization using fiducial markers
|
||
| 1 | fiducial_pose | ||||
| 1 | 2019-05-09 | fiducial_msgs |
Package containing message definitions for fiducials
Package containing message definitions for fiducials
|
||
| 1 | fiducial_lib | ||||
| 1 | fiducial_detect | ||||
| 1 | 2019-05-23 | ffha |
ffha: PDDL Planner (http://ipc.informatik.uni-freiburg.de)
ffha: PDDL Planner (http://ipc.informatik.uni-freiburg.de)
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2017-11-22 | freenect_stack |
A libfreenect-based ROS driver for the Microsoft Kinect
A libfreenect-based ROS driver for the Microsoft Kinect
|
||
| 1 | 2017-11-22 | freenect_launch |
Launch files for freenect_camera to produce rectified, registered
or disparity images. Also produce point clouds and registered
point clouds. Based on the openni_launch package.
Launch files for freenect_camera to produce rectified, registered
or disparity images. Also produce point clouds and registered
point clouds. Based on the openni_launch package.
|
||
| 1 | 2017-11-22 | freenect_camera |
A libfreenect-based ROS driver for the Microsoft Kinect. This is
a port of the OpenNI driver that uses libfreenect instead, because
on some systems with some devices it works better.
A libfreenect-based ROS driver for the Microsoft Kinect. This is
a port of the OpenNI driver that uses libfreenect instead, because
on some systems with some devices it works better.
|
||
| 1 | franka_visualization | ||||
| 1 | franka_ros | ||||
| 1 | franka_msgs | ||||
| 1 | franka_hw | ||||
| 1 | franka_gripper | ||||
| 1 | franka_example_controllers | ||||
| 1 | franka_description | ||||
| 1 | franka_control | ||||
| 1 | framefab_kr6_r900_support | ||||
| 1 | framefab_irb6600_workspace_moveit_config | ||||
| 1 | framefab_irb6600_workspace_ikfast_rail_robot_manipulator_plugin | ||||
| 1 | framefab_irb6600_support | ||||
| 1 | 2017-11-09 | frame_editor |
The frame_editor package
The frame_editor package
|
||
| 1 | foscam_8918_driver | ||||
| 1 | 2017-07-01 | forward_command_controller |
forward_command_controller
forward_command_controller
|
||
| 1 | 2017-09-22 | forte_rc_teleop |
The forte_rc_teleop package
The forte_rc_teleop package
|
||
| 1 | 2017-09-22 | forte_rc_robot |
The forte_rc_robot package
The forte_rc_robot package
|
||
| 1 | 2017-09-22 | forte_rc_mapping_slam |
The forte_rc_mapping_slam package
The forte_rc_mapping_slam package
|
||
| 1 | 2017-09-22 | forte_rc_driver |
The forte_rc_driver package
The forte_rc_driver package
|
||
| 1 | 2017-09-22 | forte_rc_description |
The forte_rc_description package
The forte_rc_description package
|
||
| 1 | 2017-09-22 | forte_rc_cloud |
The forte_rc_cloud package
The forte_rc_cloud package
|
||
| 1 | 2017-09-22 | forte_rc_2dnav |
The forte_rc_2dnav package
The forte_rc_2dnav package
|
||
| 1 | 2018-03-27 | force_torque_tools |
Tools for gravity compensation and force-torque sensor calibration.
Tools for gravity compensation and force-torque sensor calibration.
|
||
| 1 | 2017-07-01 | force_torque_sensor_controller |
Controller to publish state of force-torque sensors
Controller to publish state of force-torque sensors
|
||
| 1 | 2018-03-27 | force_torque_sensor_calib |
Calibrates the offsets of F/T sensors and the mass and position of the COM of gripper attached to the F/T sensor. Uses readings from an accelerometer that has been calibrated to the robot frame.
Calibrates the offsets of F/T sensors and the mass and position of the COM of gripper attached to the F/T sensor. Uses readings from an accelerometer that has been calibrated to the robot frame.
|
||
| 1 | force_torque_sensor | ||||
| 1 | 2018-04-15 | force_sensor_handler |
The force_sensor_handler package
The force_sensor_handler package
|
||
| 0 | force_proximity_ros | ||||
| 3 | 2018-04-17 | footstep_planner |
|
||
| 1 | follow_waypoints | ||||
| 1 | 2017-02-17 | folaga_msgs |
The folaga_msgs package
The folaga_msgs package
|
||
| 2 | fmi_adapter_examples | ||||
| 2 | fmi_adapter | ||||
| 1 | 2019-03-18 | flir_ptu_viz |
Launchfiles and rviz configs to assist with visualizing the FLIR PTUs.
Launchfiles and rviz configs to assist with visualizing the FLIR PTUs.
|
||
| 1 | 2019-03-18 | flir_ptu_driver |
Driver for the FLIR pan/tilt units.
Driver for the FLIR pan/tilt units.
|
||
| 1 | 2019-03-18 | flir_ptu_description |
URDF description the FLIR PTUs, currently the D46.
URDF description the FLIR PTUs, currently the D46.
|
||
| 1 | flir_camera_driver | ||||
| 1 | 2019-04-09 | flexbe_widget |
flexbe_widget implements some smaller scripts for the behavior engine.
flexbe_widget implements some smaller scripts for the behavior engine.
|
||
| 1 | 2019-04-09 | flexbe_testing |
flexbe_testing provides a framework for unit testing states.
flexbe_testing provides a framework for unit testing states.
|
||
| 1 | 2019-04-09 | flexbe_states |
flexbe_states provides a collection of predefined states.
Feel free to add new states.
flexbe_states provides a collection of predefined states.
Feel free to add new states.
|
||
| 1 | 2019-04-09 | flexbe_onboard |
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
|
||
| 1 | 2019-04-09 | flexbe_msgs |
flexbe_msgs provides the messages used by FlexBE.
flexbe_msgs provides the messages used by FlexBE.
|
||
| 1 | 2019-04-09 | flexbe_mirror |
flexbe_mirror implements functionality to remotely mirror an executed behavior.
flexbe_mirror implements functionality to remotely mirror an executed behavior.
|
||
| 1 | 2019-04-09 | flexbe_input |
flexbe_input enables to send data to onboard behavior when required.
flexbe_input enables to send data to onboard behavior when required.
|
||
| 1 | 2019-04-09 | flexbe_core |
flexbe_core provides the core smach extension for the FlexBE behavior engine.
flexbe_core provides the core smach extension for the FlexBE behavior engine.
|
||
| 1 | 2019-04-09 | flexbe_behavior_engine |
A meta-package to aggregate all the FlexBE packages
A meta-package to aggregate all the FlexBE packages
|
||
| 0 | flask_reverse_proxy |
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2016-05-04 | evarobot_viz |
Visualization configuration for the Evarobot.
Visualization configuration for the Evarobot.
|
||
| 1 | 2016-05-04 | evarobot_state_publisher |
evarobot_state_publisher provides tf information of Evarobot links.
evarobot_state_publisher provides tf information of Evarobot links.
|
||
| 1 | 2016-05-04 | evarobot_slam |
evarobot_slam provides roslaunch scripts for SLAM map building with the Evarobot.
evarobot_slam provides roslaunch scripts for SLAM map building with the Evarobot.
|
||
| 1 | 2016-05-05 | evarobot_simulator |
The evarobot_simulator meta package provides all the basic packages for Gazebo model.
The evarobot_simulator meta package provides all the basic packages for Gazebo model.
|
||
| 1 | 2016-05-04 | evarobot_pose_ekf |
evarobot_pose_ekf provides roslaunch scripts for correction of the Evarobot's orientation with an IMU sensor.
evarobot_pose_ekf provides roslaunch scripts for correction of the Evarobot's orientation with an IMU sensor.
|
||
| 1 | 2016-05-04 | evarobot_navigation |
evarobot_navigation provides roslaunch script files to navigate the Evarobot.
evarobot_navigation provides roslaunch script files to navigate the Evarobot.
|
||
| 1 | 2016-05-05 | evarobot_gazebo |
evarobot simulator bringup.
evarobot simulator bringup.
|
||
| 1 | 2016-05-04 | evarobot_diagnostics |
evarobot diagnostics
evarobot diagnostics
|
||
| 1 | 2016-05-04 | evarobot_description |
evarobot_description provides a complete 3D model of the Evarobot for simulation and visualization.
evarobot_description provides a complete 3D model of the Evarobot for simulation and visualization.
|
||
| 1 | 2016-05-04 | evarobot_competition |
The evarobot_competition package
The evarobot_competition package
|
||
| 1 | 2016-05-04 | evapc_start |
The evapc_start provides roslaunch scripts for starting the Evarobot base functionality in PC.
The evapc_start provides roslaunch scripts for starting the Evarobot base functionality in PC.
|
||
| 1 | 2016-05-04 | evapc_ros |
The evapc_ros meta package provides all the basic packages for model and navigation of Evarobot.
The evapc_ros meta package provides all the basic packages for model and navigation of Evarobot.
|
||
| 1 | 2017-02-23 | euslisp_model_conversion_tester |
euslisp_model_conversion_tester
euslisp_model_conversion_tester
|
||
| 1 | eusgazebo | ||||
| 1 | 2017-02-23 | euscollada |
euscollada
euscollada
|
||
| 1 | 2019-04-16 | eus_qpoases |
eus_qpoases
eus_qpoases
|
||
| 1 | 2019-04-16 | eus_nlopt |
eus_nlopt
eus_nlopt
|
||
| 2 | 2017-02-23 | eus_assimp |
eus_assimp
eus_assimp
|
||
| 1 | ethzasl_point_cloud_vtk_tools | ||||
| 1 | ethzasl_icp_mapping | ||||
| 1 | ethzasl_icp_mapper_experiments | ||||
| 1 | ethzasl_icp_mapper | ||||
| 1 | ethzasl_gridmap_2d | ||||
| 1 | ethzasl_extrinsic_calibration | ||||
| 2 | 2015-02-09 | ethercat_trigger_controllers |
Controllers to operate the digital output of the motor controller
boards and the projector board. This package has not been reviewed and
should be considered unstable.
Controllers to operate the digital output of the motor controller
boards and the projector board. This package has not been reviewed and
should be considered unstable.
|
||
| 1 | ethercat_soem | ||||
| 1 | ethercat_manager | ||||
| 3 | ethercat_hardware | ||||
| 1 | ethercat_grant | ||||
| 0 | etherbotix_python | ||||
| 1 | erratic_teleop | ||||
| 1 | erratic_player | ||||
| 1 | erratic_navigation_apps | ||||
| 1 | erratic_navigation | ||||
| 1 | erratic_gazebo_plugins | ||||
| 1 | erratic_description | ||||
| 1 | epuck_driver | ||||
| 1 | epson_g364_imu_driver | ||||
| 1 | epos_library | ||||
| 1 | epos_hardware | ||||
| 1 | epos_driver | ||||
| 1 | epos2_motor_controller | ||||
| 1 | enu | ||||
| 1 | ensenso_driver | ||||
| 1 | ensenso_description | ||||
| 1 | ensenso_camera_test | ||||
| 1 | ensenso_camera_msgs | ||||
| 1 | ensenso_camera | ||||
| 1 | ensenso | ||||
| 0 | eml |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | exotica_examples | ||||
| 1 | exotica_double_integrator_dynamics_solver | ||||
| 1 | exotica_core_task_maps | ||||
| 1 | exotica_core | ||||
| 1 | exotica_collision_scene_fcl_latest | ||||
| 1 | exotica_collision_scene_fcl | ||||
| 1 | exotica_aico_solver | ||||
| 1 | exotica | ||||
| 1 | executive_smach_visualization | ||||
| 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 | examples_rclpy_minimal_subscriber | ||||
| 1 | examples_rclpy_minimal_service | ||||
| 1 | examples_rclpy_minimal_publisher | ||||
| 1 | examples_rclpy_minimal_client | ||||
| 1 | examples_rclpy_minimal_action_server | ||||
| 1 | examples_rclpy_minimal_action_client | ||||
| 1 | examples_rclpy_executors | ||||
| 1 | examples_rclcpp_minimal_timer | ||||
| 1 | examples_rclcpp_minimal_subscriber | ||||
| 1 | examples_rclcpp_minimal_service | ||||
| 1 | examples_rclcpp_minimal_publisher | ||||
| 1 | examples_rclcpp_minimal_composition | ||||
| 1 | examples_rclcpp_minimal_client | ||||
| 1 | examples_rclcpp_minimal_action_server | ||||
| 1 | examples_rclcpp_minimal_action_client | ||||
| 1 | example_interfaces | ||||
| 1 | evarobot_viz | ||||
| 1 | evarobot_state_publisher | ||||
| 1 | evarobot_slam | ||||
| 1 | evarobot_simulator | ||||
| 1 | evarobot_pose_ekf | ||||
| 1 | evarobot_navigation | ||||
| 1 | evarobot_gazebo | ||||
| 1 | evarobot_diagnostics | ||||
| 1 | evarobot_description | ||||
| 1 | evarobot_competition | ||||
| 1 | evapc_start | ||||
| 1 | evapc_ros | ||||
| 1 | eusurdf | ||||
| 1 | euslisp_model_conversion_tester | ||||
| 1 | euscollada | ||||
| 1 | 2019-04-16 | eus_qpoases |
eus_qpoases
eus_qpoases
|
||
| 1 | 2019-04-16 | eus_nlopt |
eus_nlopt
eus_nlopt
|
||
| 2 | eus_assimp | ||||
| 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_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.
|
||
| 2 | 2015-11-03 | ethercat_trigger_controllers |
Controllers to operate the digital output of the motor controller
boards and the projector board. This package has not been reviewed and
should be considered unstable.
Controllers to operate the digital output of the motor controller
boards and the projector board. This package has not been reviewed and
should be considered unstable.
|