Packages
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-03-26 | nerian_stereo |
Driver node for SceneScan and SP1 stereo vision sensors by Nerian Vision Technologies
Driver node for SceneScan and SP1 stereo vision sensors by Nerian Vision Technologies
|
||
| 1 | 2019-01-06 | neonavigation_rviz_plugins |
Rviz plugins for neonavigation package
Rviz plugins for neonavigation package
|
||
| 1 | 2019-05-23 | neonavigation_msgs |
Message definitions for neonavigation package
Message definitions for neonavigation package
|
||
| 1 | 2019-05-24 | neonavigation_launch |
Demonstration and sample launch files for neonavigation meta-package
Demonstration and sample launch files for neonavigation meta-package
|
||
| 1 | 2019-05-24 | neonavigation_common |
Common headers for neonavigation meta-package
Common headers for neonavigation meta-package
|
||
| 1 | 2019-05-24 | neonavigation |
The neonavigation meta-package including 3-dof configuration space planner
The neonavigation meta-package including 3-dof configuration space planner
|
||
| 1 | 2018-10-04 | neobotix_usboard_msgs |
neobotix_usboard package
neobotix_usboard package
|
||
| 1 | 2018-08-31 | navigation_layers |
Extra navigation layers.
Extra navigation layers.
|
||
| 1 | 2019-03-26 | navigation_experimental |
A collection of navigation plugins and tools: Various recovery behaviors,
local and global planner plugins for move_base, a teleop filter for
obstacle avoidance, a simple control-based move_base replacement
etc.
A collection of navigation plugins and tools: Various recovery behaviors,
local and global planner plugins for move_base, a teleop filter for
obstacle avoidance, a simple control-based move_base replacement
etc.
|
||
| 2 | 2019-04-28 | navigation |
A 2D navigation stack that takes in information from odometry, sensor
streams, and a goal pose and outputs safe velocity commands that are sent
to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor
streams, and a goal pose and outputs safe velocity commands that are sent
to a mobile base.
|
||
| 2 | 2019-04-28 | navfn |
navfn provides a fast interpolated navigation function that can be used to create plans for
a mobile base. The planner assumes a circular robot and operates on a costmap to find a
minimum cost plan from a start point to an end point in a grid. The navigation function is
computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the
near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the
nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for
a mobile base. The planner assumes a circular robot and operates on a costmap to find a
minimum cost plan from a start point to an end point in a grid. The navigation function is
computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the
near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the
nav_core::BaseGlobalPlanner interface specified in
|
||
| 2 | 2018-11-08 | nav_msgs |
nav_msgs defines the common messages used to interact with the
nav_msgs defines the common messages used to interact with the
|
||
| 1 | 2019-02-12 | nav_grid_pub_sub |
Publishers and Subscribers for nav_grid data.
Publishers and Subscribers for nav_grid data.
|
||
| 1 | 2019-02-12 | nav_grid_iterators |
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
|
||
| 1 | 2019-02-12 | nav_grid |
A templatized interface for overlaying a two dimensional grid on the world.
A templatized interface for overlaying a two dimensional grid on the world.
|
||
| 1 | 2019-02-12 | nav_core_adapter |
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less).
See README.md for more information.
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less).
See README.md for more information.
|
||
| 1 | 2019-02-12 | nav_core2 |
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
|
||
| 2 | 2019-04-28 | nav_core |
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
|
||
| 2 | 2019-02-12 | nav_2d_utils |
A handful of useful utility functions for nav_core2 packages.
A handful of useful utility functions for nav_core2 packages.
|
||
| 2 | 2019-02-12 | nav_2d_msgs |
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
|
||
| 1 | 2019-03-28 | nav2d_tutorials |
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
|
||
| 1 | 2019-03-28 | nav2d_remote |
This package is used to manually control a robot that uses the operator and
navigator node from navigation_2d. Currently there is one node to control one
robot with a joystick and one to control multiple robots in simulation.
It can send commands directly to the operator or start and stop navigator actions.
This package is used to manually control a robot that uses the operator and
navigator node from navigation_2d. Currently there is one node to control one
robot with a joystick and one to control multiple robots in simulation.
It can send commands directly to the operator or start and stop navigator actions.
|
||
| 1 | 2019-03-28 | nav2d_operator |
The operator is a lightweight, purely reactive obstacle-avoidance
module for mobile robots moving in a planar environment. The operator node
works by evaluating a set of predefined motion primitives based on a local
costmap and a desired direction. The best evaluated motion command will be
send to the mobile base.
The operator is a lightweight, purely reactive obstacle-avoidance
module for mobile robots moving in a planar environment. The operator node
works by evaluating a set of predefined motion primitives based on a local
costmap and a desired direction. The best evaluated motion command will be
send to the mobile base.
|
||
| 1 | 2019-03-28 | nav2d_navigator |
This package provides a node for higher level navigation of a mobile
robot in a planar environment. It needs a map and the robot's position
within this map to create a plan for navigation. When used together with
a SLAM module it can also be used to perform autonomous exploration of
the robot's workspace.
This package provides a node for higher level navigation of a mobile
robot in a planar environment. It needs a map and the robot's position
within this map to create a plan for navigation. When used together with
a SLAM module it can also be used to perform autonomous exploration of
the robot's workspace.
|
||
| 1 | 2019-03-28 | nav2d_msgs |
Messages used for 2D-Navigation.
Messages used for 2D-Navigation.
|
||
| 1 | 2019-03-28 | nav2d_localizer |
Wrapper around Particle Filter implementation.
The SelfLocalizer can be used as library or as a ros-node.
Wrapper around Particle Filter implementation.
The SelfLocalizer can be used as library or as a ros-node.
|
||
| 1 | 2019-03-28 | nav2d_karto |
Graph-based Simultaneous Localization and Mapping module.
Includes OpenKarto GraphSLAM library by "SRI International".
Graph-based Simultaneous Localization and Mapping module.
Includes OpenKarto GraphSLAM library by "SRI International".
|
||
| 1 | 2019-03-28 | nav2d_exploration |
This package holds a collection of plugins for the RobotNavigator, that provide
different cooperative exploration strategies for a team of mobile robots.
This package holds a collection of plugins for the RobotNavigator, that provide
different cooperative exploration strategies for a team of mobile robots.
|
||
| 1 | 2019-03-28 | nav2d |
Meta-Package containing modules for 2D-Navigation
Meta-Package containing modules for 2D-Navigation
|
||
| 1 | 2015-10-09 | nanomsg |
The nanomsg package
The nanomsg package
|
||
| 1 | 2019-04-11 | mvsim |
Node for the "multivehicle simulator" framework.
Node for the "multivehicle simulator" framework.
|
||
| 1 | 2019-04-03 | multisense_ros |
multisense_ros
multisense_ros
|
||
| 1 | 2019-04-03 | multisense_lib |
multisense_lib
multisense_lib
|
||
| 1 | 2019-04-03 | multisense_description |
multisense_description
multisense_description
|
||
| 1 | 2019-04-03 | multisense_cal_check |
multisense_cal_check
multisense_cal_check
|
||
| 1 | 2019-04-03 | multisense_bringup |
multisense_bringup
multisense_bringup
|
||
| 1 | 2019-04-03 | multisense |
multisense catkin driver
multisense catkin driver
|
||
| 1 | 2018-11-04 | multires_image |
multires_image
multires_image
|
||
| 1 | 2019-04-30 | multimaster_msgs_fkie |
The messages required by multimaster packages.
The messages required by multimaster packages.
|
||
| 1 | 2019-04-30 | multimaster_fkie |
The metapackage to combine the nodes required to establish and manage a multimaster network.
This requires no or minimal configuration. The changes are automatically detected and synchronized.
The metapackage to combine the nodes required to establish and manage a multimaster network.
This requires no or minimal configuration. The changes are automatically detected and synchronized.
|
||
| 1 | 2019-04-26 | multi_object_tracking_lidar |
ROS package for Multiple objects detection, tracking and classification from LIDAR scans/point-clouds
ROS package for Multiple objects detection, tracking and classification from LIDAR scans/point-clouds
|
||
| 1 | 2019-05-22 | multi_map_server |
multi_map_server provides the
multi_map_server provides the
|
||
| 1 | 2019-03-19 | multi_interface_roam |
sdsdddsdsds
sdsdddsdsds
|
||
| 1 | 2019-04-11 | mrpt_tutorials |
Example files used as tutorials for MRPT ROS packages
Example files used as tutorials for MRPT ROS packages
|
||
| 1 | 2019-04-13 | mrpt_slam |
mrpt_slam
mrpt_slam
|
||
| 1 | 2019-04-11 | mrpt_reactivenav2d |
Reactive navigation for 2D robots using MRPT navigation algorithms (TP-Space)
Reactive navigation for 2D robots using MRPT navigation algorithms (TP-Space)
|
||
| 1 | 2019-04-13 | mrpt_rbpf_slam |
This package is used for gridmap SLAM. The interface is similar to gmapping (http://wiki.ros.org/gmapping) but the package supports different particle-filter algorithms, range-only SLAM, can work with several grid maps simultaneously and more.
This package is used for gridmap SLAM. The interface is similar to gmapping (http://wiki.ros.org/gmapping) but the package supports different particle-filter algorithms, range-only SLAM, can work with several grid maps simultaneously and more.
|
||
| 1 | 2019-04-11 | mrpt_rawlog |
This package enables you to record a rawlog from a ROS drive robot.
At the moment the package is able to deal with odometry and 2d laser scans.
This package enables you to record a rawlog from a ROS drive robot.
At the moment the package is able to deal with odometry and 2d laser scans.
|
||
| 1 | 2019-04-11 | mrpt_navigation |
Tools related to the Mobile Robot Programming Toolkit (MRPT).
Refer to http://wiki.ros.org/mrpt_navigation for further documentation.
Tools related to the Mobile Robot Programming Toolkit (MRPT).
Refer to http://wiki.ros.org/mrpt_navigation for further documentation.
|
||
| 2 | 2018-06-09 | mrpt_msgs |
ROS messages for MRPT classes and objects
ROS messages for MRPT classes and objects
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-07-10 | laser_proc |
laser_proc
laser_proc
|
||
| 1 | 2018-04-26 | laser_pipeline |
Meta-package of libraries for processing laser data, including converting laser data
into 3D representations.
Meta-package of libraries for processing laser data, including converting laser data
into 3D representations.
|
||
| 1 | 2019-02-07 | laser_geometry |
This package contains a class for converting from a 2D laser scan as defined by
sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud
or sensor_msgs/PointCloud2. In particular, it contains functionality to account
for the skew resulting from moving robots or tilting laser scanners.
This package contains a class for converting from a 2D laser scan as defined by
sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud
or sensor_msgs/PointCloud2. In particular, it contains functionality to account
for the skew resulting from moving robots or tilting laser scanners.
|
||
| 1 | 2019-05-23 | laser_filters_jsk_patch |
laser_filters_jsk_patch
laser_filters_jsk_patch
|
||
| 1 | 2019-05-23 | laser_filters |
Assorted filters designed to operate on 2D planar laser scanners,
which use the sensor_msgs/LaserScan type.
Assorted filters designed to operate on 2D planar laser scanners,
which use the sensor_msgs/LaserScan type.
|
||
| 1 | 2016-07-23 | laser_filtering |
ROS Libraries for filtering specific kinds of laser scans
ROS Libraries for filtering specific kinds of laser scans
|
||
| 1 | 2016-09-25 | laser_cb_detector |
Extracts checkerboard corners from a dense laser snapshot.
This package is experimental and unstable. Expect its APIs to change.
Extracts checkerboard corners from a dense laser snapshot.
This package is experimental and unstable. Expect its APIs to change.
|
||
| 1 | 2018-11-20 | laser_assembler |
Provides nodes to assemble point clouds from either LaserScan or PointCloud messages
Provides nodes to assemble point clouds from either LaserScan or PointCloud messages
|
||
| 1 | 2018-08-07 | kni |
This package provides the third-party KNI (Katana Native Interface) library for Katana
robot arms.
Instead of using the KNI library directly, the
This package provides the third-party KNI (Katana Native Interface) library for Katana
robot arms.
Instead of using the KNI library directly, the
|
||
| 2 | 2018-04-06 | key_teleop |
A text-based interface to send a robot movement commands
A text-based interface to send a robot movement commands
|
||
| 1 | 2019-05-16 | kdl_typekit |
This package contains the KDL RTT bindings
This package contains the KDL RTT bindings
|
||
| 2 | 2018-07-23 | 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 | 2018-07-23 | 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 | 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 | 2019-05-23 | julius_ros |
The julius_ros package
The julius_ros package
|
||
| 1 | 2019-05-23 | julius |
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
|
||
| 1 | 2019-05-03 | json_transport |
JSON transport for ROS
JSON transport for ROS
|
||
| 1 | 2019-05-03 | json_msgs |
JSON ROS message
JSON ROS message
|
||
| 1 | 2019-04-02 | jsk_roseus |
|
||
| 1 | 2018-12-05 | jsk_model_tools |
|
||
| 1 | 2018-08-08 | jsk_hark_msgs |
jsk_hark_msgs
jsk_hark_msgs
|
||
| 1 | 2018-08-08 | jsk_gui_msgs |
jsk_gui_msgs
jsk_gui_msgs
|
||
| 1 | 2018-08-08 | jsk_footstep_msgs |
jsk_footstep_msgs
jsk_footstep_msgs
|
||
| 1 | 2018-08-08 | jsk_common_msgs |
|
||
| 1 | 2019-05-23 | jsk_3rdparty |
|
||
| 2 | 2018-08-30 | jpeg_streamer |
tools for streaming JPEG-formatted CompressedImage topics over HTTP
tools for streaming JPEG-formatted CompressedImage topics over HTTP
|
||
| 1 | 2019-05-24 | joystick_interrupt |
Interrupt cmd_vel by joystick input
Interrupt cmd_vel by joystick input
|
||
| 2 | 2017-07-07 | joystick_drivers |
This metapackage depends on packages for interfacing common
joysticks and human input devices with ROS.
This metapackage depends on packages for interfacing common
joysticks and human input devices with ROS.
|
||
| 2 | 2018-04-06 | joy_teleop |
A (to be) generic joystick interface to control a robot
A (to be) generic joystick interface to control a robot
|
||
| 1 | 2016-07-23 | joy_listener |
Translates joy msgs
Translates joy msgs
|
||
| 2 | 2017-07-07 | joy |
ROS driver for a generic Linux joystick.
The joy package contains joy_node, a node that interfaces a
generic Linux joystick to ROS. This node publishes a "Joy"
message, which contains the current state of each one of the
joystick's buttons and axes.
ROS driver for a generic Linux joystick.
The joy package contains joy_node, a node that interfaces a
generic Linux joystick to ROS. This node publishes a "Joy"
message, which contains the current state of each one of the
joystick's buttons and axes.
|
||
| 1 | 2018-09-21 | joint_trajectory_generator |
joint_trajectory_generator action takes in a trajectory specified
by a number of joint positions, and it generates a new smooth trajectory
through these joint positions.
joint_trajectory_generator action takes in a trajectory specified
by a number of joint positions, and it generates a new smooth trajectory
through these joint positions.
|
||
| 1 | 2019-04-08 | joint_trajectory_controller |
Controller for executing joint-space trajectories on a group of joints.
Controller for executing joint-space trajectories on a group of joints.
|
||
| 1 | 2018-09-21 | joint_trajectory_action_tools |
joint_trajectory_action_tools
joint_trajectory_action_tools
|
||
| 2 | 2018-09-20 | joint_trajectory_action |
The joint_trajectory_action is a node that exposes an action interface
to a joint trajectory controller.
The joint_trajectory_action is a node that exposes an action interface
to a joint trajectory controller.
|
||
| 1 | 2016-09-25 | joint_states_settler |
Provides a node that reports how long a subset of joints has been
settled. That is, it calculates how long a set of joints has remained
within a specified threshold. This package is experimental and unstable.
Expect its APIs to change.
Provides a node that reports how long a subset of joints has been
settled. That is, it calculates how long a set of joints has remained
within a specified threshold. This package is experimental and unstable.
Expect its APIs to change.
|
||
| 2 | 2019-01-16 | joint_state_publisher |
This package contains a tool for setting and publishing joint state values for a given URDF.
This package contains a tool for setting and publishing joint state values for a given URDF.
|
||
| 1 | 2019-04-08 | joint_state_controller |
Controller to publish joint state
Controller to publish joint state
|
||
| 1 | 2018-10-09 | joint_limits_interface |
Interface for enforcing joint limits.
Interface for enforcing joint limits.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-07-09 | ros_environment |
The package provides the environment variables `ROS_VERSION`, `ROS_DISTRO`, `ROS_PACKAGE_PATH`, and `ROS_ETC_DIR`.
The package provides the environment variables `ROS_VERSION`, `ROS_DISTRO`, `ROS_PACKAGE_PATH`, and `ROS_ETC_DIR`.
|
||
| 1 | 2018-10-16 | ros_emacs_utils |
A metapackage of Emacs utils for ROS.
Only there for simplifying the release process.
A metapackage of Emacs utils for ROS.
Only there for simplifying the release process.
|
||
| 2 | 2018-04-02 | ros_core |
A metapackage to aggregate the packages required to use publish / subscribe, services, launch files, and other core ROS concepts.
A metapackage to aggregate the packages required to use publish / subscribe, services, launch files, and other core ROS concepts.
|
||
| 1 | 2019-04-08 | ros_controllers |
Library of ros controllers
Library of ros controllers
|
||
| 1 | 2018-10-09 | ros_control |
A set of packages that include controller interfaces, controller managers, transmissions and hardware_interfaces.
A set of packages that include controller interfaces, controller managers, transmissions and hardware_interfaces.
|
||
| 2 | 2019-02-01 | ros_comm |
ROS communications-related packages, including core client libraries (roscpp, rospy) and graph introspection tools (rostopic, rosnode, rosservice, rosparam).
ROS communications-related packages, including core client libraries (roscpp, rospy) and graph introspection tools (rostopic, rosnode, rosservice, rosparam).
|
||
| 1 | 2019-05-04 | ros_canopen |
A generic canopen implementation for ROS
A generic canopen implementation for ROS
|
||
| 1 | 2018-09-12 | ros_broker |
ros comm broker package.
ros comm broker package.
|
||
| 2 | 2018-04-02 | ros_base |
A metapackage which extends ros_core and includes other basic non-robot tools like actionlib, dynamic reconfigure, nodelets, and pluginlib.
A metapackage which extends ros_core and includes other basic non-robot tools like actionlib, dynamic reconfigure, nodelets, and pluginlib.
|
||
| 1 | 2018-03-21 | ros_apache2 |
ros_apache2
ros_apache2
|
||
| 1 | 2019-03-29 | ros |
ROS packaging system
ROS packaging system
|
||
| 1 | 2018-05-09 | roomblock_navigation |
The roomblock_navigation package
The roomblock_navigation package
|
||
| 1 | 2018-05-09 | roomblock_mapping |
The roomblock_mapping package
The roomblock_mapping package
|
||
| 1 | 2018-05-09 | roomblock_description |
The roomblock_description package
The roomblock_description package
|
||
| 1 | 2018-05-09 | roomblock_bringup |
The roomblock_bringup package
The roomblock_bringup package
|
||
| 1 | 2018-05-09 | roomblock |
The roomblock meta package
The roomblock meta package
|
||
| 1 | 2016-03-24 | roomba_stage |
The roomba_stage package
The roomba_stage package
|
||
| 1 | 2017-03-28 | romeo_sensors_py |
Package that adds the depth camera to Romeo
Package that adds the depth camera to Romeo
|
||
| 1 | 2017-03-28 | romeo_robot |
The romeo_robot metapackage
The romeo_robot metapackage
|
||
| 1 | 2017-11-16 | romeo_moveit_config |
An automatically generated package with all the configuration and launch files for using the romeoH37 with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the romeoH37 with the MoveIt Motion Planning Framework
|
||
| 1 | 2017-11-16 | romeo_gazebo_plugin |
The romeo_gazebo_plugin package
The romeo_gazebo_plugin package
|
||
| 1 | 2017-03-28 | romeo_description |
The romeo_description package
The romeo_description package
|
||
| 1 | 2017-11-16 | romeo_control |
Control for Aldebaran's ROMEO robot
Control for Aldebaran's ROMEO robot
|
||
| 1 | 2017-03-28 | romeo_bringup |
The romeo_bringup package
contains launch and configuration files required to bring ROS interfaces for Romeo up into a running state.
The romeo_bringup package
contains launch and configuration files required to bring ROS interfaces for Romeo up into a running state.
|
||
| 1 | 2017-06-14 | rodi_robot |
RoDI ROS package.
Allows to control a RoDI from the Robot Operating System (ROS) without the need
to flash a custom firmware and just using the default firmware web services API.
RoDI ROS package.
Allows to control a RoDI from the Robot Operating System (ROS) without the need
to flash a custom firmware and just using the default firmware web services API.
|
||
| 1 | 2016-05-10 | rocon_uri |
Module for working with rocon uri strings.
Module for working with rocon uri strings.
|
||
| 1 | 2016-06-17 | rocon_unreliable_experiments |
Some experiments testing roscpp unreliable transports.
Some experiments testing roscpp unreliable transports.
|
||
| 1 | 2016-05-05 | rocon_tutorial_msgs |
Messages used by rocon tutorials.
Messages used by rocon tutorials.
|
||
| 1 | 2016-05-10 | rocon_tools |
Utilities and tools developed for rocon, but usable beyond the boundaries
of rocon.
Utilities and tools developed for rocon, but usable beyond the boundaries
of rocon.
|
||
| 1 | 2016-06-17 | rocon_test |
Rocon test framework (i.e. multi-launch rostest framework).
Rocon test framework (i.e. multi-launch rostest framework).
|
||
| 1 | 2016-05-05 | rocon_std_msgs |
Standard messages used by other rocon specific package types.
Standard messages used by other rocon specific package types.
|
||
| 1 | 2016-05-05 | rocon_service_pair_msgs |
Paired pubsubs generators for non-blocking services.
Paired pubsubs generators for non-blocking services.
|
||
| 1 | 2016-05-10 | rocon_semantic_version |
Internal packaging of the 2.2.2 version of the python semantic version module.
Internal packaging of the 2.2.2 version of the python semantic version module.
|
||
| 1 | 2016-05-10 | rocon_python_wifi |
The pythonwifi package is available through pypi, but not through a
deb package. This is copy of the package suitable for use through the
ROS ecosystem.
The pythonwifi package is available through pypi, but not through a
deb package. This is copy of the package suitable for use through the
ROS ecosystem.
|
||
| 1 | 2016-05-10 | rocon_python_utils |
Python system and ros utilities.
Python system and ros utilities.
|
||
| 1 | 2016-05-10 | rocon_python_redis |
Locally patched version of the python redis client (https://github.com/andymccurdy/redis-py).
Locally patched version of the python redis client (https://github.com/andymccurdy/redis-py).
|
||
| 1 | 2016-05-10 | rocon_python_comms |
Service pair libraries for pub/sub non-blocking services.
Service pair libraries for pub/sub non-blocking services.
|
||
| 1 | 2016-06-17 | rocon_multimaster |
This doesn't do everything you need for multimaster, however it does
provide the building blocks common to most or all multimaster systems.
In particular, it provides the gateway model, which is an upgrade on
old foreign_relay and master_sync concepts.
This doesn't do everything you need for multimaster, however it does
provide the building blocks common to most or all multimaster systems.
In particular, it provides the gateway model, which is an upgrade on
old foreign_relay and master_sync concepts.
|
||
| 1 | 2016-05-05 | rocon_msgs |
Communication types (msgs/srvs/actions) for robotics in concert (aka multimaster).
Communication types (msgs/srvs/actions) for robotics in concert (aka multimaster).
|
||
| 1 | 2016-05-10 | rocon_master_info |
Publish master information - name, description, icon.
Publish master information - name, description, icon.
|
||
| 1 | 2016-05-10 | rocon_launch |
A multi-roslaunch (for single and multi-master systems).
A multi-roslaunch (for single and multi-master systems).
|
||
| 1 | 2016-05-10 | rocon_interactions |
Interaction management for human interactive agents in the concert.
Interaction management for human interactive agents in the concert.
|
||
| 1 | 2016-05-05 | rocon_interaction_msgs |
Messages used by rocon interactions.
Messages used by rocon interactions.
|
||
| 1 | 2016-05-10 | rocon_icons |
Icons for rocon.
Icons for rocon.
|
||
| 1 | 2016-06-17 | rocon_hub_client |
Client api for discovery and connection to rocon hubs. It also has
a few convenience api for manipulating data on the hub.
Client api for discovery and connection to rocon hubs. It also has
a few convenience api for manipulating data on the hub.
|
||
| 1 | 2016-06-17 | rocon_hub |
A hub acts as a shared key-value store for multiple ros
systems (primarily used by gateways).
A hub acts as a shared key-value store for multiple ros
systems (primarily used by gateways).
|
||
| 1 | 2016-06-17 | rocon_gateway_utils |
Utilities for gateway users (avoids large dependency requirements).
Utilities for gateway users (avoids large dependency requirements).
|
||
| 1 | 2016-06-17 | rocon_gateway_tests |
Testing programs for gateways.
Testing programs for gateways.
|
||
| 1 | 2016-06-17 | rocon_gateway |
A hub acts as a shared key-value store for multiple ros
systems (primarily used by gateways).
A hub acts as a shared key-value store for multiple ros
systems (primarily used by gateways).
|
||
| 1 | 2016-05-10 | rocon_ebnf |
Internal packaging of the 0.91 version of the simple python
Internal packaging of the 0.91 version of the simple python
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-03-25 | rosdiagnostic |
Command to print aggregated diagnostic contents to the command line
Command to print aggregated diagnostic contents to the command line
|
||
| 1 | 2017-03-06 | roscreate |
roscreate contains a tool that assists in the creation of ROS filesystem resources.
It provides:
roscreate contains a tool that assists in the creation of ROS filesystem resources.
It provides:
|
||
| 1 | 2016-03-18 | roscpp_tutorials |
This package attempts to show the features of ROS step-by-step,
including using messages, servers, parameters, etc.
This package attempts to show the features of ROS step-by-step,
including using messages, servers, parameters, etc.
|
||
| 1 | 2017-03-06 | roscpp_traits |
roscpp_traits contains the message traits code as described in
roscpp_traits contains the message traits code as described in
|
||
| 1 | 2017-03-06 | roscpp_serialization |
roscpp_serialization contains the code for serialization as described in
roscpp_serialization contains the code for serialization as described in
|
||
| 1 | 2017-03-06 | roscpp_core |
Underlying data libraries for roscpp messages.
Underlying data libraries for roscpp messages.
|
||
| 2 | 2017-03-06 | roscpp |
roscpp is a C++ implementation of ROS. It provides
a
roscpp is a C++ implementation of ROS. It provides
a
|
||
| 1 | 2016-04-18 | rosconsole_bridge |
rosconsole_bridge is a package used in conjunction with console_bridge and rosconsole for connecting console_bridge-based logging to rosconsole-based logging.
rosconsole_bridge is a package used in conjunction with console_bridge and rosconsole for connecting console_bridge-based logging to rosconsole-based logging.
|
||
| 2 | 2017-03-06 | rosconsole |
ROS console output library.
ROS console output library.
|
||
| 1 | 2019-05-23 | roscompile |
The roscompile package
The roscompile package
|
||
| 1 | 2017-03-06 | rosclean |
rosclean: cleanup filesystem resources (e.g. log files).
rosclean: cleanup filesystem resources (e.g. log files).
|
||
| 1 | 2017-03-06 | rosbuild |
rosbuild contains scripts for managing the CMake-based build system for ROS.
rosbuild contains scripts for managing the CMake-based build system for ROS.
|
||
| 1 | 2017-12-08 | rosbridge_suite |
Rosbridge provides a JSON API to ROS functionality for non-ROS programs.
There are a variety of front ends that interface with rosbridge, including
a WebSocket server for web browsers to interact with.
Rosbridge_suite is a meta-package containing rosbridge, various front end
packages for rosbridge like a WebSocket package, and helper packages.
Rosbridge provides a JSON API to ROS functionality for non-ROS programs.
There are a variety of front ends that interface with rosbridge, including
a WebSocket server for web browsers to interact with.
Rosbridge_suite is a meta-package containing rosbridge, various front end
packages for rosbridge like a WebSocket package, and helper packages.
|
||
| 1 | 2017-12-08 | rosbridge_server |
A WebSocket interface to rosbridge.
A WebSocket interface to rosbridge.
|
||
| 1 | 2017-12-08 | rosbridge_library |
The core rosbridge package, repsonsible for interpreting JSON andperforming
the appropriate ROS action, like subscribe, publish, call service, and
interact with params.
The core rosbridge package, repsonsible for interpreting JSON andperforming
the appropriate ROS action, like subscribe, publish, call service, and
interact with params.
|
||
| 1 | 2017-03-06 | rosboost_cfg |
Contains scripts used by the rosboost-cfg tool for determining cflags/lflags/etc. of boost on your system
Contains scripts used by the rosboost-cfg tool for determining cflags/lflags/etc. of boost on your system
|
||
| 1 | 2019-03-17 | rosbash_params |
Tools for writing ros-node-like bash scripts
Tools for writing ros-node-like bash scripts
|
||
| 1 | 2017-03-06 | rosbash |
Assorted shell commands for using ros with bash.
Assorted shell commands for using ros with bash.
|
||
| 1 | 2015-07-11 | rosbaglive |
Plays rosbags as though they were happening NOW.
Plays rosbags as though they were happening NOW.
|
||
| 2 | 2017-03-06 | rosbag_storage |
This is a set of tools for recording from and playing back ROS
message without relying on the ROS client library.
This is a set of tools for recording from and playing back ROS
message without relying on the ROS client library.
|
||
| 1 | 2013-08-16 | rosbag_migration_rule |
This empty package allows to export rosbag migration rule files without depending on rosbag.
This empty package allows to export rosbag migration rule files without depending on rosbag.
|
||
| 1 | 2014-12-15 | rosbag_image_compressor |
The rosbag_image_compressor package.
This package has a script to compress and decompress images inside a bag file.
The rosbag_image_compressor package.
This package has a script to compress and decompress images inside a bag file.
|
||
| 2 | 2017-03-06 | rosbag |
This is a set of tools for recording from and playing back to ROS
topics. It is intended to be high performance and avoids
deserialization and reserialization of the messages.
This is a set of tools for recording from and playing back to ROS
topics. It is intended to be high performance and avoids
deserialization and reserialization of the messages.
|
||
| 2 | 2018-08-16 | rosauth |
Server Side tools for Authorization and Authentication of ROS Clients
Server Side tools for Authorization and Authentication of ROS Clients
|
||
| 1 | 2015-02-06 | rosatomic |
rosatomic provides the C++11-style atomic operations by pulling symbols from the proposed Boost.Atomic
package into the ros namespace. Once C++11-style atomics (std::atomic) are available from compilers, rosatomic will
conditionally use those instead.
rosatomic provides the C++11-style atomic operations by pulling symbols from the proposed Boost.Atomic
package into the ros namespace. Once C++11-style atomics (std::atomic) are available from compilers, rosatomic will
conditionally use those instead.
|
||
| 1 | 2017-12-08 | rosapi |
Provides service calls for getting ros meta-information, like list of
topics, services, params, etc.
Provides service calls for getting ros meta-information, like list of
topics, services, params, etc.
|
||
| 1 | 2014-10-30 | ros_web_video |
Streaming of ROS Image Topics via HTTP
Streaming of ROS Image Topics via HTTP
|
||
| 1 | 2019-05-14 | ros_type_introspection |
The ros_type_introspection package allows the user to parse and deserialize
ROS messages which type is unknown at compilation time.
The ros_type_introspection package allows the user to parse and deserialize
ROS messages which type is unknown at compilation time.
|
||
| 1 | 2016-03-18 | ros_tutorials |
ros_tutorials contains packages that demonstrate various features of ROS,
as well as support packages which help demonstrate those features.
ros_tutorials contains packages that demonstrate various features of ROS,
as well as support packages which help demonstrate those features.
|
||
| 1 | 2014-08-18 | ros_topology_msgs |
Messages describing the topology of the ros graph.
Messages describing the topology of the ros graph.
|
||
| 1 | 2014-08-18 | ros_statistics_msgs |
ROS Host and Node Statistics Messages
ROS Host and Node Statistics Messages
|
||
| 1 | 2019-05-23 | ros_speech_recognition |
ROS wrapper for Python SpeechRecognition library
ROS wrapper for Python SpeechRecognition library
|
||
| 1 | 2015-02-06 | ros_realtime |
The ros_realtime package
The ros_realtime package
|
||
| 1 | 2015-01-12 | ros_package_web_server |
Web server to host ROS package content
Web server to host ROS package content
|
||
| 1 | 2019-03-28 | ros_numpy |
A collection of conversion function for extracting numpy arrays from messages
A collection of conversion function for extracting numpy arrays from messages
|
||
| 1 | 2019-05-23 | ros_introspection |
The ros_introspection package
The ros_introspection package
|
||
| 1 | 2017-10-02 | ros_explorer |
A web interface for exploring the ROS graph
A web interface for exploring the ROS graph
|
||
| 1 | 2016-03-04 | ros_ethernet_rmp |
ROS Wrapper for the Segway RMP Ethernet Python Driver
ROS Wrapper for the Segway RMP Ethernet Python Driver
|
||
| 1 | 2017-01-10 | ros_ethercat_model |
The mechanism model
The mechanism model
|
||
| 1 | 2017-01-10 | ros_ethercat_loop |
Main loop to run EtherCAT robot hardware.
Main loop to run EtherCAT robot hardware.
|
||
| 1 | 2017-01-10 | ros_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
|
||
| 2 | 2017-01-10 | ros_ethercat_eml |
This is an implementation of the EtherCAT master protocol for use wiht ros_ethercar package
based on the work done at Flanders' Mechatronics Technology Centre and Willow Garage.
This is an implementation of the EtherCAT master protocol for use wiht ros_ethercar package
based on the work done at Flanders' Mechatronics Technology Centre and Willow Garage.
|
||
| 1 | 2017-01-10 | ros_ethercat |
A pr2 agnostic replacement for robots using EtherCAT
A pr2 agnostic replacement for robots using EtherCAT
|
||
| 1 | 2018-10-16 | ros_emacs_utils |
A metapackage of Emacs utils for ROS.
Only there for simplifying the release process.
A metapackage of Emacs utils for ROS.
Only there for simplifying the release process.
|
||
| 2 | 2018-04-02 | ros_core |
A metapackage to aggregate the packages required to use publish / subscribe, services, launch files, and other core ROS concepts.
A metapackage to aggregate the packages required to use publish / subscribe, services, launch files, and other core ROS concepts.
|
||
| 1 | 2017-07-01 | ros_controllers |
Library of ros controllers
Library of ros controllers
|
||
| 1 | 2018-05-31 | ros_control |
A set of packages that include controller interfaces, controller managers, transmissions, hardware_interfaces and the control_toolbox.
A set of packages that include controller interfaces, controller managers, transmissions, hardware_interfaces and the control_toolbox.
|
||
| 2 | 2017-03-06 | ros_comm |
ROS communications-related packages, including core client libraries (roscpp, rospy) and graph introspection tools (rostopic, rosnode, rosservice, rosparam).
ROS communications-related packages, including core client libraries (roscpp, rospy) and graph introspection tools (rostopic, rosnode, rosservice, rosparam).
|
||
| 1 | 2018-05-22 | ros_canopen |
A generic canopen implementation for ROS
A generic canopen implementation for ROS
|
||
| 1 | 2018-09-12 | ros_broker |
ros comm broker package.
ros comm broker package.
|
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-06-03 | laser_scan_matcher |
|
||
| 1 | 2018-07-10 | laser_proc |
laser_proc
laser_proc
|
||
| 1 | 2018-04-26 | laser_pipeline |
Meta-package of libraries for processing laser data, including converting laser data
into 3D representations.
Meta-package of libraries for processing laser data, including converting laser data
into 3D representations.
|
||
| 1 | 2018-06-03 | laser_ortho_projector |
The laser_ortho_projector package calculates orthogonal projections of LaserScan messages.
The laser_ortho_projector package calculates orthogonal projections of LaserScan messages.
|
||
| 1 | 2019-02-07 | laser_geometry |
This package contains a class for converting from a 2D laser scan as defined by
sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud
or sensor_msgs/PointCloud2. In particular, it contains functionality to account
for the skew resulting from moving robots or tilting laser scanners.
This package contains a class for converting from a 2D laser scan as defined by
sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud
or sensor_msgs/PointCloud2. In particular, it contains functionality to account
for the skew resulting from moving robots or tilting laser scanners.
|
||
| 1 | 2019-05-23 | laser_filters_jsk_patch |
laser_filters_jsk_patch
laser_filters_jsk_patch
|
||
| 1 | 2019-05-23 | laser_filters |
Assorted filters designed to operate on 2D planar laser scanners,
which use the sensor_msgs/LaserScan type.
Assorted filters designed to operate on 2D planar laser scanners,
which use the sensor_msgs/LaserScan type.
|
||
| 1 | 2016-07-23 | laser_filtering |
ROS Libraries for filtering specific kinds of laser scans
ROS Libraries for filtering specific kinds of laser scans
|
||
| 1 | 2016-09-25 | laser_cb_detector |
Extracts checkerboard corners from a dense laser snapshot.
This package is experimental and unstable. Expect its APIs to change.
Extracts checkerboard corners from a dense laser snapshot.
This package is experimental and unstable. Expect its APIs to change.
|
||
| 1 | 2018-11-20 | laser_assembler |
Provides nodes to assemble point clouds from either LaserScan or PointCloud messages
Provides nodes to assemble point clouds from either LaserScan or PointCloud messages
|
||
| 1 | 2016-11-12 | korg_nanokontrol |
ROS driver to use the Korg NanoKontrol MIDI device as a joystick.
ROS driver to use the Korg NanoKontrol MIDI device as a joystick.
|
||
| 1 | 2018-01-31 | kni |
This package provides the third-party KNI (Katana Native Interface) library for Katana
robot arms.
Instead of using the KNI library directly, the
This package provides the third-party KNI (Katana Native Interface) library for Katana
robot arms.
Instead of using the KNI library directly, the
|
||
| 1 | 2017-07-08 | keyboard |
publishes keyboard key presses
publishes keyboard key presses
|
||
| 2 | 2018-04-06 | key_teleop |
A text-based interface to send a robot movement commands
A text-based interface to send a robot movement commands
|
||
| 1 | 2019-05-16 | kdl_typekit |
This package contains the KDL RTT bindings
This package contains the KDL RTT bindings
|
||
| 2 | 2018-07-23 | 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 | 2018-07-23 | 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 | 2018-01-31 | 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-01-31 | 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-01-31 | katana_msgs |
This package contains messages specific to the Neuronics Katana arm.
This package contains messages specific to the Neuronics Katana arm.
|
||
| 1 | 2018-01-31 | katana_moveit_ikfast_plugin |
The katana_moveit_ikfast_plugin package
The katana_moveit_ikfast_plugin package
|
||
| 1 | 2018-01-31 | 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-01-31 | 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-01-31 | 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-01-31 | 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-01-31 | 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 | 2015-07-11 | kalman_filter |
Simple Kalman Filter in Python
Simple Kalman Filter in Python
|
||
| 1 | 2019-05-23 | julius_ros |
The julius_ros package
The julius_ros package
|
||
| 1 | 2019-05-23 | julius |
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
julius: Open-Source Large Vocabulary CSR Engine (http://julius.sourceforge.jp/index.php)
|
||
| 1 | 2018-05-22 | json_prolog_msgs |
Message definitions to talk with the JSON Prolog interface.
Message definitions to talk with the JSON Prolog interface.
|
||
| 1 | 2017-03-06 | jskeus |
EusLisp software developed and used by JSK at The University of Tokyo
EusLisp software developed and used by JSK at The University of Tokyo
|
||
| 1 | 2017-02-13 | jsk_visualization |
|
||
| 1 | 2019-05-22 | jsk_topic_tools |
jsk_topic_tools
jsk_topic_tools
|
||
| 1 | 2019-05-22 | jsk_tools |
Includes emacs scripts, ros tool alias generator, and launch doc generator.
Includes emacs scripts, ros tool alias generator, and launch doc generator.
|
||
| 1 | 2019-05-22 | jsk_tilt_laser |
The jsk_tilt_laser package
The jsk_tilt_laser package
|
||
| 1 | 2019-04-16 | jsk_teleop_joy |
jsk_teleop_joy
jsk_teleop_joy
|
||
| 1 | 2017-02-13 | jsk_rviz_plugins |
The jsk_rviz_plugins package
The jsk_rviz_plugins package
|
||
| 1 | 2017-02-13 | jsk_rqt_plugins |
The jsk_rqt_plugins package
The jsk_rqt_plugins package
|
||
| 1 | 2019-04-02 | jsk_roseus |
|
||
| 1 | 2019-05-15 | jsk_recognition_utils |
C++ library about sensor model, geometrical modeling and perception.
C++ library about sensor model, geometrical modeling and perception.
|
||
| 1 | 2019-05-15 | jsk_recognition_msgs |
ROS messages for jsk_pcl_ros and jsk_perception.
ROS messages for jsk_pcl_ros and jsk_perception.
|
||
| 1 | 2019-05-15 | jsk_recognition |
|
||
| 1 | 2019-04-27 | jsk_pr2eus |
|
||
| 1 | 2017-03-03 | jsk_planning |
|
||
| 1 | 2019-05-15 | jsk_perception |
ROS nodes and nodelets for 2-D image perception.
ROS nodes and nodelets for 2-D image perception.
|
||
| 1 | 2019-05-15 | jsk_pcl_ros_utils |
ROS utility nodelets for pointcloud perception.
ROS utility nodelets for pointcloud perception.
|
||
| 1 | 2019-05-15 | jsk_pcl_ros |
ROS nodelets for pointcloud perception.
ROS nodelets for pointcloud perception.
|
||
| 1 | 2019-05-22 | jsk_network_tools |
jsk_network_tools
jsk_network_tools
|
||
| 1 | 2017-02-23 | jsk_model_tools |
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2017-01-20 | nao_meshes |
meshes for the Aldebaran Robotics NAO
meshes for the Aldebaran Robotics NAO
|
||
| 1 | 2019-05-23 | nao_jsk_teleop |
nao_jsk_teleop
nao_jsk_teleop
|
||
| 2 | 2018-01-29 | nao_interaction_msgs |
Messages and services declarations for the nao_interaction metapackage
Messages and services declarations for the nao_interaction metapackage
|
||
| 2 | 2018-01-29 | nao_interaction_launchers |
Launchers for bringing up the nodes of nao_interaction metapackage.
Launchers for bringing up the nodes of nao_interaction metapackage.
|
||
| 2 | 2018-01-29 | nao_interaction |
|
||
| 1 | 2018-05-03 | nao_gazebo_plugin |
The nao_gazebo_plugin package
The nao_gazebo_plugin package
|
||
| 1 | 2016-02-15 | nao_extras |
Extra tools for the Nao robot: teleoperation with a gamepad and path following. Renamed
from the nao_common stack.
Extra tools for the Nao robot: teleoperation with a gamepad and path following. Renamed
from the nao_common stack.
|
||
| 1 | 2018-10-30 | nao_description |
Description of the Nao robot model that can be used with robot_state_publisher to display the robot's state of joint angles.
Description of the Nao robot model that can be used with robot_state_publisher to display the robot's state of joint angles.
|
||
| 1 | 2018-05-03 | nao_control |
The nao_control package
The nao_control package
|
||
| 1 | 2018-10-30 | nao_bringup |
Launch files and scripts needed to bring ROS interfaces for Nao up into a
running state.
Launch files and scripts needed to bring ROS interfaces for Nao up into a
running state.
|
||
| 2 | 2018-01-29 | nao_audio |
Package for the Nao robot, providing access to NAOqi audio proxies
Package for the Nao robot, providing access to NAOqi audio proxies
|
||
| 1 | 2018-10-30 | nao_apps |
Applications for NAO using the NAOqi API
Applications for NAO using the NAOqi API
|
||
| 1 | 2019-04-03 | multisense_ros |
multisense_ros
multisense_ros
|
||
| 1 | 2019-04-03 | multisense_lib |
multisense_lib
multisense_lib
|
||
| 1 | 2019-04-03 | multisense_description |
multisense_description
multisense_description
|
||
| 1 | 2019-04-03 | multisense_cal_check |
multisense_cal_check
multisense_cal_check
|
||
| 1 | 2019-04-03 | multisense_bringup |
multisense_bringup
multisense_bringup
|
||
| 1 | 2019-04-03 | multisense |
multisense catkin driver
multisense catkin driver
|
||
| 1 | 2015-04-27 | multimaster_msgs_fkie |
The messages required by multimaster packages.
The messages required by multimaster packages.
|
||
| 1 | 2015-04-27 | multimaster_fkie |
The metapackage to combine the nodes required to establish and manage a multimaster network.
This requires no or minimal configuration. The changes are automatically detected and synchronized.
The metapackage to combine the nodes required to establish and manage a multimaster network.
This requires no or minimal configuration. The changes are automatically detected and synchronized.
|
||
| 1 | 2019-05-22 | multi_map_server |
multi_map_server provides the
multi_map_server provides the
|
||
| 2 | 2015-03-24 | multi_level_map_utils |
Contains utilities like a level multiplexer, a level selector and other utility functions.
Contains utilities like a level multiplexer, a level selector and other utility functions.
|
||
| 2 | 2015-03-24 | multi_level_map_server |
Launches a map server for various floors inside a building.
Launches a map server for various floors inside a building.
|
||
| 2 | 2015-03-24 | multi_level_map_msgs |
Messages used by the multi floor map server and navigation code.
Messages used by the multi floor map server and navigation code.
|
||
| 1 | 2015-03-24 | multi_level_map |
Metapackage which pulls in all the other packages required to run a multi level map server and perform multi level map manipulations.
Metapackage which pulls in all the other packages required to run a multi level map server and perform multi level map manipulations.
|
||
| 1 | 2019-02-26 | multi_interface_roam |
sdsdddsdsds
sdsdddsdsds
|
||
| 1 | 2014-04-22 | mr_tools |
Some useful nodes for multi-robot teleoperation
Some useful nodes for multi-robot teleoperation
|
||
| 1 | 2014-04-22 | mr_teleoperator |
Multi-robot teleoperation package collection
Multi-robot teleoperation package collection
|
||
| 1 | 2014-04-22 | mr_rqt |
Multi-robot teleoperation package collection
Multi-robot teleoperation package collection
|
||
| 1 | 2015-07-09 | moveit_simple_grasps |
A basic grasp generator for simple objects such as blocks or cylinders for use with the MoveIt! pick and place pipeline.
Does not consider friction cones or other dynamics.
A basic grasp generator for simple objects such as blocks or cylinders for use with the MoveIt! pick and place pipeline.
Does not consider friction cones or other dynamics.
|
||
| 2 | 2014-09-12 | moveit_simple_controller_manager |
A generic, simple controller manager plugin for MoveIt.
A generic, simple controller manager plugin for MoveIt.
|
||
| 2 | 2014-08-19 | moveit_setup_assistant |
Generates a configuration package that makes it easy to use MoveIt!
Generates a configuration package that makes it easy to use MoveIt!
|
||
| 2 | 2015-04-13 | moveit_ros_warehouse |
Components of MoveIt connecting to MongoDB
Components of MoveIt connecting to MongoDB
|
||
| 2 | 2015-04-13 | moveit_ros_visualization |
Components of MoveIt that offer visualization
Components of MoveIt that offer visualization
|
||
| 2 | 2015-04-13 | moveit_ros_robot_interaction |
Components of MoveIt that offer interaction via interactive markers
Components of MoveIt that offer interaction via interactive markers
|
||
| 2 | 2015-04-13 | moveit_ros_planning_interface |
Components of MoveIt that offer simpler interfaces to planning and execution
Components of MoveIt that offer simpler interfaces to planning and execution
|
||
| 2 | 2015-04-13 | moveit_ros_planning |
Planning components of MoveIt that use ROS
Planning components of MoveIt that use ROS
|
||
| 2 | 2015-04-13 | moveit_ros_perception |
Components of MoveIt connecting to perception
Components of MoveIt connecting to perception
|
||
| 2 | 2015-04-13 | moveit_ros_move_group |
The move_group node for MoveIt
The move_group node for MoveIt
|
||
| 2 | 2015-04-13 | moveit_ros_manipulation |
Components of MoveIt used for manipulation
Components of MoveIt used for manipulation
|
||
| 2 | 2015-04-13 | moveit_ros_benchmarks_gui |
MoveIt GUI tools for benchmarking
MoveIt GUI tools for benchmarking
|
||
| 2 | 2015-04-13 | moveit_ros_benchmarks |
MoveIt tools for benchmarking
MoveIt tools for benchmarking
|
||
| 2 | 2015-04-13 | moveit_ros |
Components of MoveIt that use ROS
Components of MoveIt that use ROS
|
||
| 1 | 2019-04-03 | moveit_resources |
Resources used for MoveIt! testing
Resources used for MoveIt! testing
|
||
| 1 | 2018-08-13 | moveit_python |
A pure-python interaface to the MoveIt! ROS API.
A pure-python interaface to the MoveIt! ROS API.
|
||
| 1 | 2015-12-05 | moveit_pr2 |
All PR2-specific packages for MoveIt
All PR2-specific packages for MoveIt
|
||
| 2 | 2014-09-12 | moveit_plugins |
Metapackage for moveit plugins.
Metapackage for moveit plugins.
|
||
| 2 | 2015-06-03 | moveit_planners_ompl |
MoveIt interface to OMPL
MoveIt interface to OMPL
|
||
| 2 | 2015-06-03 | moveit_planners |
Metapacakge that installs all available planners for MoveIt
Metapacakge that installs all available planners for MoveIt
|
||
| 1 | 2014-03-10 | moveit_msgs |
Messages, services and actions used by MoveIt
Messages, services and actions used by MoveIt
|