Packages
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | indoor_positioning | ||||
| 1 | indoor_localization | ||||
| 1 | 2019-01-30 | imu_transformer |
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
|
||
| 1 | 2019-05-06 | imu_tools |
Various tools for IMU devices
Various tools for IMU devices
|
||
| 1 | 2019-04-11 | imu_sensor_controller |
Controller to publish state of IMU sensors
Controller to publish state of IMU sensors
|
||
| 1 | imu_recalibration | ||||
| 1 | 2019-01-30 | imu_processors |
Processors for sensor_msgs::Imu data
Processors for sensor_msgs::Imu data
|
||
| 1 | 2019-01-30 | imu_pipeline |
imu_pipeline
imu_pipeline
|
||
| 2 | imu_monitor | ||||
| 1 | imu_handler | ||||
| 1 | 2019-05-06 | imu_filter_madgwick |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
|
||
| 0 | imu_drivers | ||||
| 1 | 2019-05-06 | imu_complementary_filter |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into a quaternion to represent the orientation of the device wrt the global frame. Based on the algorithm by Roberto G. Valenti etal. described in the paper "Keeping a Good Attitude: A Quaternion-Based Orientation Filter for IMUs and MARGs" available at http://www.mdpi.com/1424-8220/15/8/19302 .
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into a quaternion to represent the orientation of the device wrt the global frame. Based on the algorithm by Roberto G. Valenti etal. described in the paper "Keeping a Good Attitude: A Quaternion-Based Orientation Filter for IMUs and MARGs" available at http://www.mdpi.com/1424-8220/15/8/19302 .
|
||
| 1 | imu_compass | ||||
| 1 | imi_camera | ||||
| 1 | 2017-09-29 | imagezero_ros |
A library that provides convenient methods for manipulating ROS images with ImageZero
A library that provides convenient methods for manipulating ROS images with ImageZero
|
||
| 1 | 2017-09-29 | imagezero_image_transport |
A plugin to image_transport for transparently sending images encoded with ImageZero.
A plugin to image_transport for transparently sending images encoded with ImageZero.
|
||
| 1 | 2019-05-15 | imagesift |
For every image, computes its sift features and send a new message with the image, its intrinsic parameters, and the features.
Parameters include:
display - shows the image on the local computer
For every image, computes its sift features and send a new message with the image, its intrinsic parameters, and the features.
Parameters include:
display - shows the image on the local computer
|
||
| 1 | 2018-05-10 | image_view |
A simple viewer for ROS image topics. Includes a specialized viewer
for stereo + disparity images.
A simple viewer for ROS image topics. Includes a specialized viewer
for stereo + disparity images.
|
||
| 1 | 2016-10-03 | image_transport_plugins |
A set of plugins for publishing and subscribing to sensor_msgs/Image topics
in representations other than raw pixel data. For example, for viewing a
stream of images off-robot, a video codec will give much lower bandwidth
and latency. For low frame rate tranport of high-definition images, you
might prefer sending them as JPEG or PNG-compressed form.
A set of plugins for publishing and subscribing to sensor_msgs/Image topics
in representations other than raw pixel data. For example, for viewing a
stream of images off-robot, a video codec will give much lower bandwidth
and latency. For low frame rate tranport of high-definition images, you
might prefer sending them as JPEG or PNG-compressed form.
|
||
| 1 | 2017-11-05 | image_transport |
image_transport should always be used to subscribe to and publish images. It provides transparent
support for transporting images in low-bandwidth compressed formats. Examples (provided by separate
plugin packages) include JPEG/PNG compression and Theora streaming video.
image_transport should always be used to subscribe to and publish images. It provides transparent
support for transporting images in low-bandwidth compressed formats. Examples (provided by separate
plugin packages) include JPEG/PNG compression and Theora streaming video.
|
||
| 1 | image_tools | ||||
| 1 | image_stream | ||||
| 1 | 2018-05-10 | image_rotate |
|
||
| 1 | image_recognition_util | ||||
| 1 | image_recognition_tensorflow_rqt | ||||
| 1 | image_recognition_tensorflow | ||||
| 1 | image_recognition_skybiometry | ||||
| 1 | image_recognition_rqt | ||||
| 1 | image_recognition_openpose | ||||
| 1 | image_recognition_openface | ||||
| 1 | image_recognition_msgs | ||||
| 1 | image_recognition_keras | ||||
| 1 | image_recognition_jetson | ||||
| 1 | image_recognition_analysis | ||||
| 1 | image_recognition | ||||
| 1 | 2018-05-10 | image_publisher |
|
||
| 1 | 2018-05-10 | image_proc |
Single image rectification and color processing.
Single image rectification and color processing.
|
||
| 1 | 2018-05-10 | image_pipeline |
image_pipeline fills the gap between getting raw images from a camera driver and higher-level vision processing.
image_pipeline fills the gap between getting raw images from a camera driver and higher-level vision processing.
|
||
| 1 | image_overlay_scale_and_compass | ||||
| 2 | 2018-04-30 | image_geometry |
`image_geometry` contains C++ and Python libraries for interpreting images
geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo
messages with OpenCV functions such as image rectification, much as cv_bridge
interfaces ROS sensor_msgs/Image with OpenCV data types.
`image_geometry` contains C++ and Python libraries for interpreting images
geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo
messages with OpenCV functions such as image rectification, much as cv_bridge
interfaces ROS sensor_msgs/Image with OpenCV data types.
|
||
| 1 | image_exposure_msgs | ||||
| 1 | 2017-11-05 | image_common |
Common code for working with images in ROS.
Common code for working with images in ROS.
|
||
| 1 | 2016-09-25 | image_cb_detector |
Provide a node that extracts checkerboard corners from ROS images.
This package is still experimental and unstable.
Expect its APIs to change.
Provide a node that extracts checkerboard corners from ROS images.
This package is still experimental and unstable.
Expect its APIs to change.
|
||
| 1 | im_msgs | ||||
| 1 | iiwa | ||||
| 1 | ihmc_ros_java_adapter | ||||
| 1 | ihmc_ros_diagnostics | ||||
| 1 | ihmc_ros_core | ||||
| 1 | ihmc_ros_control |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | image_recognition_analysis | ||||
| 1 | image_recognition | ||||
| 1 | 2018-05-10 | image_publisher |
|
||
| 1 | 2018-05-10 | image_proc |
Single image rectification and color processing.
Single image rectification and color processing.
|
||
| 1 | 2018-05-10 | image_pipeline |
image_pipeline fills the gap between getting raw images from a camera driver and higher-level vision processing.
image_pipeline fills the gap between getting raw images from a camera driver and higher-level vision processing.
|
||
| 1 | image_overlay_scale_and_compass | ||||
| 2 | 2018-04-16 | image_geometry |
`image_geometry` contains C++ and Python libraries for interpreting images
geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo
messages with OpenCV functions such as image rectification, much as cv_bridge
interfaces ROS sensor_msgs/Image with OpenCV data types.
`image_geometry` contains C++ and Python libraries for interpreting images
geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo
messages with OpenCV functions such as image rectification, much as cv_bridge
interfaces ROS sensor_msgs/Image with OpenCV data types.
|
||
| 1 | 2018-03-27 | image_exposure_msgs |
Messages related to the Point Grey camera driver.
Messages related to the Point Grey camera driver.
|
||
| 1 | 2017-11-05 | image_common |
Common code for working with images in ROS.
Common code for working with images in ROS.
|
||
| 1 | 2016-09-25 | image_cb_detector |
Provide a node that extracts checkerboard corners from ROS images.
This package is still experimental and unstable.
Expect its APIs to change.
Provide a node that extracts checkerboard corners from ROS images.
This package is still experimental and unstable.
Expect its APIs to change.
|
||
| 1 | im_msgs | ||||
| 1 | iiwa | ||||
| 1 | iirob_filters | ||||
| 1 | ihmc_ros_java_adapter | ||||
| 1 | ihmc_ros_diagnostics | ||||
| 1 | ihmc_ros_core | ||||
| 1 | ihmc_ros_control | ||||
| 1 | ihmc_ros_common | ||||
| 1 | ihmc_msgs | ||||
| 1 | igvc_self_drive_sim | ||||
| 1 | igvc_self_drive_gazebo_plugins | ||||
| 1 | igvc_self_drive_gazebo | ||||
| 1 | igvc_self_drive_description | ||||
| 1 | ifm_o3mxxx | ||||
| 1 | 2019-02-26 | ieee80211_channels |
This package provides mapping from frequencies to
IEEE802.11 channels and vice-versa.
This package provides mapping from frequencies to
IEEE802.11 channels and vice-versa.
|
||
| 1 | idolink_node | ||||
| 1 | icart_mini_gazebo | ||||
| 1 | icart_mini_driver | ||||
| 1 | icart_mini_description | ||||
| 1 | icart_mini_control | ||||
| 1 | icart_mini | ||||
| 1 | 2018-10-04 | ibeo_msgs |
Package containing messages for Ibeo sensors.
Package containing messages for Ibeo sensors.
|
||
| 1 | iav_depthimage_to_laserscan | ||||
| 0 | ias_knowledge_base | ||||
| 1 | iai_wsg_50_msgs | ||||
| 1 | iai_urdf_msgs | ||||
| 0 | iai_robosherlock_actions | ||||
| 1 | iai_pepper_demo_msgs | ||||
| 1 | iai_kinematics_msgs | ||||
| 1 | iai_control_msgs | ||||
| 1 | iai_content_msgs | ||||
| 1 | iai_common_msgs | ||||
| 0 | hypothesis | ||||
| 3 | husky_viz | ||||
| 1 | husky_ur5_moveit_config | ||||
| 1 | husky_teleop | ||||
| 2 | husky_simulator | ||||
| 2 | husky_robot | ||||
| 2 | husky_navigation | ||||
| 1 | husky_msgs |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-05-20 | kinesis_manager |
AWS Kinesis stream management library intended for use with the Kinesis Video Producer SDK
AWS Kinesis stream management library intended for use with the Kinesis Video Producer SDK
|
||
| 0 | kinematics_plugin_loader | ||||
| 1 | kinematics_cache_ros | ||||
| 0 | kinematics_cache | ||||
| 0 | kinematics_base | ||||
| 0 | kinematic_constraints | ||||
| 1 | kinect_aux | ||||
| 1 | kinect_2d_scanner | ||||
| 1 | 2019-05-15 | khi_rs_ikfast_plugin |
The khi_rs_ikfast_plugin package
The khi_rs_ikfast_plugin package
|
||
| 1 | 2019-05-15 | khi_rs_gazebo |
The khi_rs_gazebo package
The khi_rs_gazebo package
|
||
| 1 | 2019-05-15 | khi_rs_description |
The khi_rs_description package
The khi_rs_description package
|
||
| 1 | 2019-05-15 | khi_rs080n_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs080n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs080n with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-05-15 | khi_rs007n_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs007n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs007n with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-05-15 | khi_rs007l_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs007l with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs007l with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-05-15 | khi_robot_msgs |
This package contains KHI ROS robot msgs
This package contains KHI ROS robot msgs
|
||
| 1 | 2019-05-15 | khi_robot_control |
ROS KHI robot controller package based on ros_control
ROS KHI robot controller package based on ros_control
|
||
| 1 | 2019-05-15 | khi_robot |
Meta package for khi_robot
Meta package for khi_robot
|
||
| 1 | 2019-05-15 | khi_duaro_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_duaro with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_duaro with the MoveIt! Motion Planning Framework
|
||
| 1 | 2019-05-15 | khi_duaro_ikfast_plugin |
The khi_duaro_ikfast_plugin package
The khi_duaro_ikfast_plugin package
|
||
| 1 | 2019-05-15 | khi_duaro_gazebo |
The khi_duaro_gazebo package
The khi_duaro_gazebo package
|
||
| 1 | 2019-05-15 | khi_duaro_description |
The khi_duaro_description package
The khi_duaro_description package
|
||
| 1 | keystroke | ||||
| 1 | keyboard | ||||
| 1 | kdl_wrapper | ||||
| 1 | 2019-05-16 | kdl_typekit |
This package contains the KDL RTT bindings
This package contains the KDL RTT bindings
|
||
| 2 | 2017-05-17 | kdl_parser_py |
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
|
||
| 3 | 2017-05-17 | kdl_parser |
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
|
||
| 1 | 2018-07-06 | kdl_conversions |
Conversion functions between KDL and geometry_msgs types.
Conversion functions between KDL and geometry_msgs types.
|
||
| 1 | kdl_acc_solver | ||||
| 0 | kdl | ||||
| 1 | 2018-08-07 | katana_tutorials |
This package contains test and demo programs for the katana_driver stack.
This package contains test and demo programs for the katana_driver stack.
|
||
| 1 | 2018-08-07 | katana_teleop |
This package provides tele-operation nodes to control the Neuronics Katana 450 arm via keyboard commands or with a playstation 3 controller.
This package provides tele-operation nodes to control the Neuronics Katana 450 arm via keyboard commands or with a playstation 3 controller.
|
||
| 1 | 2018-08-07 | katana_msgs |
This package contains messages specific to the Neuronics Katana arm.
This package contains messages specific to the Neuronics Katana arm.
|
||
| 1 | 2018-08-07 | katana_moveit_ikfast_plugin |
The katana_moveit_ikfast_plugin package
The katana_moveit_ikfast_plugin package
|
||
| 1 | 2018-08-07 | katana_gazebo_plugins |
This package provides Gazebo plugins to simulate the Katana arm.
This package provides Gazebo plugins to simulate the Katana arm.
|
||
| 1 | 2018-08-07 | katana_driver |
This stack contains all descriptions, drivers and bringup facilities for Neuronics Katana 450 arm.
This stack contains all descriptions, drivers and bringup facilities for Neuronics Katana 450 arm.
|
||
| 1 | 2018-08-07 | katana_description |
This package contains an URDF description of the Katana arm and all supporting mesh files.
This package contains an URDF description of the Katana arm and all supporting mesh files.
|
||
| 1 | 2018-08-07 | katana_arm_gazebo |
This package starts a Neuronics Katana robot arm in the Gazebo simulation environment. It is modeled after the
This package starts a Neuronics Katana robot arm in the Gazebo simulation environment. It is modeled after the
|
||
| 1 | 2018-08-07 | katana |
This package provides ROS interfaces to the Neuronics Katana 450 arm.
It wraps the
This package provides ROS interfaces to the Neuronics Katana 450 arm.
It wraps the
|
||
| 1 | 2018-10-04 | kartech_linear_actuator_msgs |
The kartech_linear_actuator_msgs package
The kartech_linear_actuator_msgs package
|
||
| 1 | 2016-07-23 | kalman_filter |
Simple Kalman Filter in Python
Simple Kalman Filter in Python
|
||
| 1 | 2017-03-14 | k-sap_pkg |
sap_pkg
sap_pkg
|
||
| 1 | 2017-03-14 | k-saap_pkg |
sap_pkg
sap_pkg
|
||
| 1 | 2019-05-23 | julius |
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
|
||
| 1 | 2019-05-03 | json_transport |
JSON transport for ROS
JSON transport for ROS
|
||
| 1 | json_prolog_msgs | ||||
| 0 | json_prolog | ||||
| 1 | 2019-05-03 | json_msgs |
JSON ROS message
JSON ROS message
|
||
| 1 | 2019-04-29 | jsk_visualization |
|
||
| 1 | 2019-05-22 | jsk_topic_tools |
jsk_topic_tools
jsk_topic_tools
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | kinova_demo | ||||
| 1 | kinova_control | ||||
| 1 | kinova_bringup | ||||
| 1 | kinova_arm_moveit_demo | ||||
| 1 | kingfisher_viz | ||||
| 1 | kingfisher_teleop | ||||
| 1 | kingfisher_desktop | ||||
| 1 | 2014-12-02 | kingfisher_description |
URDF description for Kingfisher
URDF description for Kingfisher
|
||
| 1 | kinesis_video_streamer | ||||
| 1 | kinesis_video_msgs | ||||
| 1 | kinesis_manager | ||||
| 0 | kinematics_plugin_loader | ||||
| 1 | kinematics_cache_ros | ||||
| 0 | kinematics_cache | ||||
| 0 | kinematics_base | ||||
| 0 | kinematic_constraints | ||||
| 1 | khi_rs_ikfast_plugin | ||||
| 1 | khi_rs_gazebo | ||||
| 1 | khi_rs_description | ||||
| 1 | khi_rs080n_moveit_config | ||||
| 1 | khi_rs007n_moveit_config | ||||
| 1 | khi_rs007l_moveit_config | ||||
| 1 | khi_robot_msgs | ||||
| 1 | khi_robot_control | ||||
| 1 | khi_robot_bringup | ||||
| 1 | khi_robot | ||||
| 1 | khi_duaro_moveit_config | ||||
| 1 | khi_duaro_ikfast_plugin | ||||
| 1 | khi_duaro_gazebo | ||||
| 1 | khi_duaro_description | ||||
| 1 | keystroke | ||||
| 1 | kdl_wrapper | ||||
| 1 | 2019-05-16 | kdl_typekit |
This package contains the KDL RTT bindings
This package contains the KDL RTT bindings
|
||
| 2 | 2017-05-17 | kdl_parser_py |
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
|
||
| 3 | 2017-05-17 | kdl_parser |
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
The Kinematics and Dynamics Library (KDL) defines a tree structure
to represent the kinematic and dynamic parameters of a robot
mechanism.
|
||
| 1 | 2018-07-06 | kdl_conversions |
Conversion functions between KDL and geometry_msgs types.
Conversion functions between KDL and geometry_msgs types.
|
||
| 1 | kdl_acc_solver | ||||
| 0 | kdl | ||||
| 1 | 2018-08-07 | katana_tutorials |
This package contains test and demo programs for the katana_driver stack.
This package contains test and demo programs for the katana_driver stack.
|
||
| 1 | 2018-08-07 | katana_teleop |
This package provides tele-operation nodes to control the Neuronics Katana 450 arm via keyboard commands or with a playstation 3 controller.
This package provides tele-operation nodes to control the Neuronics Katana 450 arm via keyboard commands or with a playstation 3 controller.
|
||
| 1 | 2018-08-07 | katana_msgs |
This package contains messages specific to the Neuronics Katana arm.
This package contains messages specific to the Neuronics Katana arm.
|
||
| 1 | 2018-08-07 | katana_moveit_ikfast_plugin |
The katana_moveit_ikfast_plugin package
The katana_moveit_ikfast_plugin package
|
||
| 1 | 2018-08-07 | katana_gazebo_plugins |
This package provides Gazebo plugins to simulate the Katana arm.
This package provides Gazebo plugins to simulate the Katana arm.
|
||
| 1 | 2018-08-07 | katana_driver |
This stack contains all descriptions, drivers and bringup facilities for Neuronics Katana 450 arm.
This stack contains all descriptions, drivers and bringup facilities for Neuronics Katana 450 arm.
|
||
| 1 | 2018-08-07 | katana_description |
This package contains an URDF description of the Katana arm and all supporting mesh files.
This package contains an URDF description of the Katana arm and all supporting mesh files.
|
||
| 1 | 2018-08-07 | katana_arm_gazebo |
This package starts a Neuronics Katana robot arm in the Gazebo simulation environment. It is modeled after the
This package starts a Neuronics Katana robot arm in the Gazebo simulation environment. It is modeled after the
|
||
| 1 | 2018-08-07 | katana |
This package provides ROS interfaces to the Neuronics Katana 450 arm.
It wraps the
This package provides ROS interfaces to the Neuronics Katana 450 arm.
It wraps the
|
||
| 1 | 2018-10-04 | kartech_linear_actuator_msgs |
The kartech_linear_actuator_msgs package
The kartech_linear_actuator_msgs package
|
||
| 1 | 2015-07-11 | kalman_filter |
Simple Kalman Filter in Python
Simple Kalman Filter in Python
|
||
| 1 | k-sap_pkg |
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2017-01-15 | industrial_trajectory_filters |
|
||
| 1 | industrial_robot_status_interface | ||||
| 1 | industrial_robot_status_controller | ||||
| 1 | 2017-01-15 | industrial_robot_simulator |
The industrial robot simulator is a stand in for industrial robot driver node(s). It adheres to the driver specification for industrial robot controllers.
The industrial robot simulator is a stand in for industrial robot driver node(s). It adheres to the driver specification for industrial robot controllers.
|
||
| 0 | industrial_robot_pkg_gen | ||||
| 1 | 2017-01-15 | industrial_robot_client |
industrial robot client contains generic clients for connecting
to industrial robot controllers with servers that adhere to the
simple message protocol.
industrial robot client contains generic clients for connecting
to industrial robot controllers with servers that adhere to the
simple message protocol.
|
||
| 0 | industrial_robot_angle_conversions | ||||
| 1 | 2017-01-15 | industrial_msgs |
The industrial message package containes industrial specific messages
definitions. This package is part of the ROS-Industrial program.
The industrial message package containes industrial specific messages
definitions. This package is part of the ROS-Industrial program.
|
||
| 1 | industrial_moveit_test_support | ||||
| 1 | industrial_moveit_test_moveit_config | ||||
| 1 | industrial_moveit_benchmarking | ||||
| 1 | industrial_moveit | ||||
| 1 | industrial_extrinsic_cal | ||||
| 1 | industrial_desktop | ||||
| 1 | 2017-01-15 | industrial_deprecated |
The Industrial deprecated package contains nodes, launch files, etc... that are slated for
deprecation. This package is the last place something will end up before being deleted.
If you are missing a package/node and find it's contents here, then you should consider
a replacement.
The Industrial deprecated package contains nodes, launch files, etc... that are slated for
deprecation. This package is the last place something will end up before being deleted.
If you are missing a package/node and find it's contents here, then you should consider
a replacement.
|
||
| 1 | 2017-01-15 | industrial_core |
ROS-Industrial core stack contains packages and libraries for supporing industrial systems
ROS-Industrial core stack contains packages and libraries for supporing industrial systems
|
||
| 1 | industrial_collision_detection | ||||
| 1 | 2019-05-22 | industrial_ci |
This package contains CI (Continuous Integration) configuration that any ROS-powered packages can commonly use. Some notable feature:
This package contains CI (Continuous Integration) configuration that any ROS-powered packages can commonly use. Some notable feature:
|
||
| 1 | industrial_calibration_gui | ||||
| 1 | indoor_positioning | ||||
| 1 | indoor_localization | ||||
| 1 | 2019-01-30 | imu_transformer |
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
|
||
| 1 | 2017-05-22 | imu_tools |
Various tools for IMU devices
Various tools for IMU devices
|
||
| 1 | 2016-08-10 | imu_sensor_controller |
Controller to publish state of IMU sensors
Controller to publish state of IMU sensors
|
||
| 1 | imu_recalibration | ||||
| 1 | 2019-01-30 | imu_processors |
Processors for sensor_msgs::Imu data
Processors for sensor_msgs::Imu data
|
||
| 1 | 2019-01-30 | imu_pipeline |
imu_pipeline
imu_pipeline
|
||
| 2 | imu_monitor | ||||
| 1 | 2018-04-15 | imu_handler |
The imu_handler package
The imu_handler package
|
||
| 1 | 2017-05-22 | imu_filter_madgwick |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
|
||
| 0 | imu_drivers | ||||
| 1 | 2017-05-22 | imu_complementary_filter |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into a quaternion to represent the orientation of the device wrt the global frame. Based on the algorithm by Roberto G. Valenti etal. described in the paper "Keeping a Good Attitude: A Quaternion-Based Orientation Filter for IMUs and MARGs" available at http://www.mdpi.com/1424-8220/15/8/19302 .
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into a quaternion to represent the orientation of the device wrt the global frame. Based on the algorithm by Roberto G. Valenti etal. described in the paper "Keeping a Good Attitude: A Quaternion-Based Orientation Filter for IMUs and MARGs" available at http://www.mdpi.com/1424-8220/15/8/19302 .
|
||
| 1 | imu_compass | ||||
| 1 | imi_camera | ||||
| 1 | 2016-10-14 | imagezero_ros |
A library that provides convenient methods for manipulating ROS images with ImageZero
A library that provides convenient methods for manipulating ROS images with ImageZero
|
||
| 1 | 2016-10-14 | imagezero_image_transport |
A plugin to image_transport for transparently sending images encoded with ImageZero.
A plugin to image_transport for transparently sending images encoded with ImageZero.
|
||
| 1 | 2019-05-15 | imagesift |
For every image, computes its sift features and send a new message with the image, its intrinsic parameters, and the features.
Parameters include:
display - shows the image on the local computer
For every image, computes its sift features and send a new message with the image, its intrinsic parameters, and the features.
Parameters include:
display - shows the image on the local computer
|
||
| 1 | 2018-05-10 | image_view |
A simple viewer for ROS image topics. Includes a specialized viewer
for stereo + disparity images.
A simple viewer for ROS image topics. Includes a specialized viewer
for stereo + disparity images.
|
||
| 1 | 2016-10-03 | image_transport_plugins |
A set of plugins for publishing and subscribing to sensor_msgs/Image topics
in representations other than raw pixel data. For example, for viewing a
stream of images off-robot, a video codec will give much lower bandwidth
and latency. For low frame rate tranport of high-definition images, you
might prefer sending them as JPEG or PNG-compressed form.
A set of plugins for publishing and subscribing to sensor_msgs/Image topics
in representations other than raw pixel data. For example, for viewing a
stream of images off-robot, a video codec will give much lower bandwidth
and latency. For low frame rate tranport of high-definition images, you
might prefer sending them as JPEG or PNG-compressed form.
|
||
| 1 | 2017-11-05 | image_transport |
image_transport should always be used to subscribe to and publish images. It provides transparent
support for transporting images in low-bandwidth compressed formats. Examples (provided by separate
plugin packages) include JPEG/PNG compression and Theora streaming video.
image_transport should always be used to subscribe to and publish images. It provides transparent
support for transporting images in low-bandwidth compressed formats. Examples (provided by separate
plugin packages) include JPEG/PNG compression and Theora streaming video.
|
||
| 1 | image_tools | ||||
| 1 | image_stream | ||||
| 1 | 2018-05-10 | image_rotate |
|
||
| 1 | image_recognition_util | ||||
| 1 | image_recognition_tensorflow_rqt | ||||
| 1 | image_recognition_tensorflow | ||||
| 1 | image_recognition_skybiometry | ||||
| 1 | image_recognition_rqt | ||||
| 1 | image_recognition_openpose | ||||
| 1 | image_recognition_openface |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | innok_heros_control | ||||
| 1 | informed_object_search | ||||
| 1 | infinisoleil | ||||
| 1 | indyrp_moveit_config | ||||
| 1 | indyrp_description | ||||
| 1 | indyrp2_moveit_config | ||||
| 1 | indyrp2_description | ||||
| 1 | indy_driver | ||||
| 1 | indy7_moveit_config | ||||
| 1 | indy7_description | ||||
| 1 | indy5_moveit_config | ||||
| 1 | indy5_description | ||||
| 1 | 2014-01-21 | industrial_utils |
Industrial utils is a library package that captures common funcitonality for the ROS-Industrial distribution.
Industrial utils is a library package that captures common funcitonality for the ROS-Industrial distribution.
|
||
| 1 | 2014-01-21 | industrial_trajectory_filters |
|
||
| 1 | industrial_robot_status_interface | ||||
| 1 | industrial_robot_status_controller | ||||
| 1 | 2014-01-21 | industrial_robot_simulator |
The industrial robot simulator is a stand in for industrial robot driver node(s). It adheres to the driver specification for industrial robot controllers.
The industrial robot simulator is a stand in for industrial robot driver node(s). It adheres to the driver specification for industrial robot controllers.
|
||
| 0 | industrial_robot_pkg_gen | ||||
| 1 | 2014-01-21 | industrial_robot_client |
industrial robot client contains generic clients for connecting
to industrial robot controllers with servers that adhere to the
simple message protocol.
industrial robot client contains generic clients for connecting
to industrial robot controllers with servers that adhere to the
simple message protocol.
|
||
| 0 | industrial_robot_angle_conversions | ||||
| 1 | 2014-01-21 | industrial_msgs |
The industrial message package containes industrial specific messages
definitions. This package is part of the ROS-Industrial program.
The industrial message package containes industrial specific messages
definitions. This package is part of the ROS-Industrial program.
|
||
| 1 | industrial_moveit_test_support | ||||
| 1 | industrial_moveit_test_moveit_config | ||||
| 1 | industrial_moveit_benchmarking | ||||
| 1 | industrial_moveit | ||||
| 1 | 2014-04-14 | industrial_extrinsic_cal |
The industrial_extrinsic_cal package
The industrial_extrinsic_cal package
|
||
| 1 | 2014-06-02 | industrial_desktop |
The industrial_desktop package contains all "released" packages
The industrial_desktop package contains all "released" packages
|
||
| 1 | 2014-01-21 | industrial_deprecated |
The Industrial deprecated package contains nodes, launch files, etc... that are slated for
deprecation. This package is the last place something will end up before being deleted.
If you are missing a package/node and find it's contents here, then you should consider
a replacement.
The Industrial deprecated package contains nodes, launch files, etc... that are slated for
deprecation. This package is the last place something will end up before being deleted.
If you are missing a package/node and find it's contents here, then you should consider
a replacement.
|
||
| 1 | 2014-01-21 | industrial_core |
ROS-Industrial core stack contains packages and libraries for supporing industrial systems
ROS-Industrial core stack contains packages and libraries for supporing industrial systems
|
||
| 1 | industrial_collision_detection | ||||
| 1 | industrial_ci | ||||
| 1 | 2014-04-14 | industrial_calibration_gui |
The industrial_calibration_gui package
The industrial_calibration_gui package
|
||
| 1 | indoor_positioning | ||||
| 1 | indoor_localization | ||||
| 1 | imu_transformer | ||||
| 1 | 2015-09-25 | imu_tools |
Various tools for IMU devices
Various tools for IMU devices
|
||
| 1 | 2014-10-28 | imu_sensor_controller |
Controller to publish state of IMU sensors
Controller to publish state of IMU sensors
|
||
| 1 | 2015-05-20 | imu_recalibration |
Tools to recalibrate the on-board IMUs of the KURT robot.
Tools to recalibrate the on-board IMUs of the KURT robot.
|
||
| 1 | imu_processors | ||||
| 2 | 2016-03-01 | imu_monitor |
This package contains a single node that monitors the drift of the IMU
gyroscopes. The results are published to the '/diagnostics' topic and
are aggregated in the PR2 dashboard.
This package contains a single node that monitors the drift of the IMU
gyroscopes. The results are published to the '/diagnostics' topic and
are aggregated in the PR2 dashboard.
|
||
| 1 | 2018-04-15 | imu_handler |
The imu_handler package
The imu_handler package
|
||
| 1 | 2015-09-25 | imu_filter_madgwick |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
|
||
| 0 | imu_drivers | ||||
| 1 | imu_complementary_filter | ||||
| 1 | imi_camera | ||||
| 1 | imagezero_ros | ||||
| 1 | imagezero_image_transport | ||||
| 1 | imagezero | ||||
| 1 | 2019-05-15 | imagesift |
For every image, computes its sift features and send a new message with the image, its intrinsic parameters, and the features.
Parameters include:
display - shows the image on the local computer
For every image, computes its sift features and send a new message with the image, its intrinsic parameters, and the features.
Parameters include:
display - shows the image on the local computer
|
||
| 1 | 2015-05-16 | image_view |
A simple viewer for ROS image topics. Includes a specialized viewer
for stereo + disparity images.
A simple viewer for ROS image topics. Includes a specialized viewer
for stereo + disparity images.
|