Packages
Packages
Packages
Packages
Packages
Packages
Packages
Packages
Packages
Packages
Packages
Packages
Packages
Packages
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2015-02-10 | program_queue |
program_queue
program_queue
|
|
1 | 2015-02-10 | pr2_simple_interface |
pr2_simple_interface
pr2_simple_interface
|
|
1 | 2015-02-10 | pr2_ps3_joystick_app |
Teleop PS3 joystick application for the pr2
Teleop PS3 joystick application for the pr2
|
|
1 | 2015-02-10 | pr2_props_app |
Application files for running PR2 props
Application files for running PR2 props
|
|
2 | 2015-02-10 | pr2_props |
pr2_props is a package designed to be the first step towards replacing your real (or imaginary) friends with a robot. Robot gives you mad props yo.
pr2_props is a package designed to be the first step towards replacing your real (or imaginary) friends with a robot. Robot gives you mad props yo.
|
|
1 | 2015-02-10 | pr2_map_navigation_app |
Map nav for the PR2.
Map nav for the PR2.
|
|
1 | 2015-02-10 | pr2_make_a_map_app |
Make maps using the PR2 robot.
Make maps using the PR2 robot.
|
|
1 | 2015-02-10 | pr2_joint_teleop |
pr2_joint_teleop
pr2_joint_teleop
|
|
1 | 2015-02-10 | pr2_hack_the_future |
The pr2_hack_the_future package
The pr2_hack_the_future package
|
|
1 | 2015-02-10 | kurt3d |
kurt3d
kurt3d
|
|
1 | 2015-02-10 | hack_the_web_program_executor |
hack_the_web_program_executor
hack_the_web_program_executor
|
|
2 | 2015-02-09 | single_joint_position_action |
The single joint position action is a node that provides an action
interface for commanding a trajectory to move a joint to a particular
position. The action reports success when the joint reaches the desired
position.
The single joint position action is a node that provides an action
interface for commanding a trajectory to move a joint to a particular
position. The action reports success when the joint reaches the desired
position.
|
|
2 | 2015-02-09 | robot_mechanism_controllers |
Generic Mechanism Controller Library
Generic Mechanism Controller Library
|
|
2 | 2015-02-09 | pr2_mechanism_controllers |
The pr2_mechanism_controllers package contains realtime
controllers that are meant for specific mechanisms of the PR2.
The pr2_mechanism_controllers package contains realtime
controllers that are meant for specific mechanisms of the PR2.
|
|
2 | 2015-02-09 | pr2_head_action |
The PR2 head action is a node that provides an action interface for
pointing the head of the PR2. It passes trajectory goals to the
controller, and reports success when they have finished executing.
The PR2 head action is a node that provides an action interface for
pointing the head of the PR2. It passes trajectory goals to the
controller, and reports success when they have finished executing.
|
|
2 | 2015-02-09 | pr2_gripper_action |
The pr2_gripper_action provides an action interface for using the
gripper. Users can specify what position to move to (while limiting the
force) and the action will report success when the position is reached or
failure when the gripper cannot move any longer.
The pr2_gripper_action provides an action interface for using the
gripper. Users can specify what position to move to (while limiting the
force) and the action will report success when the position is reached or
failure when the gripper cannot move any longer.
|
|
2 | 2015-02-09 | pr2_controllers_msgs |
Messages, services, and actions used in the pr2_controllers stack.
Messages, services, and actions used in the pr2_controllers stack.
|
|
2 | 2015-02-09 | pr2_controllers |
Contains the controllers that run in realtime on the PR2 and supporting packages.
Contains the controllers that run in realtime on the PR2 and supporting packages.
|
|
2 | 2015-02-09 | pr2_calibration_controllers |
The pr2_calibration_controllers package contains the controllers
used to bring all the joints in the PR2 to a calibrated state.
The pr2_calibration_controllers package contains the controllers
used to bring all the joints in the PR2 to a calibrated state.
|
|
2 | 2015-02-09 | 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.
|
|
2 | 2015-02-09 | ethercat_trigger_controllers |
Controllers to operate the digital output of the motor controller
boards and the projector board. This package has not been reviewed and
should be considered unstable.
Controllers to operate the digital output of the motor controller
boards and the projector board. This package has not been reviewed and
should be considered unstable.
|
|
1 | 2015-02-06 | rosrt |
rosrt provides classes for interfacing with ROS from within realtime systems, such as realtime-safe Publisher and Subscriber classes.
rosrt provides classes for interfacing with ROS from within realtime systems, such as realtime-safe Publisher and Subscriber classes.
|
|
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 | 2015-02-06 | ros_realtime |
The ros_realtime package
The ros_realtime package
|
|
1 | 2015-02-06 | pr2_delivery |
This package contains scripts for making a PR2 deliver a small
object from one place to another, and return to a home base.
This package contains scripts for making a PR2 deliver a small
object from one place to another, and return to a home base.
|
|
1 | 2015-02-06 | lockfree |
The lockfree package contains lock-free data structures for use in multithreaded programming. These
kinds of data structures are generally not as easy to use as single-threaded equivalents, and are not
always faster. If you don't know you need to use one, try another structure with a lock around it
first.
The lockfree package contains lock-free data structures for use in multithreaded programming. These
kinds of data structures are generally not as easy to use as single-threaded equivalents, and are not
always faster. If you don't know you need to use one, try another structure with a lock around it
first.
|
|
1 | 2015-02-06 | allocators |
Contains aligned allocation functions, as well as an STL-compatible AlignedAllocator class.
Contains aligned allocation functions, as well as an STL-compatible AlignedAllocator class.
|
|
1 | 2015-02-05 | uwsim_osgocean |
The OSG Ocean library adapted to UWSim. See https://code.google.com/p/osgocean
The OSG Ocean library adapted to UWSim. See https://code.google.com/p/osgocean
|
|
1 | 2015-02-02 | yaml_cpp_0_3 |
Legacy version of yaml cpp without boost, namespaced to avoid system conflicts.
Legacy version of yaml cpp without boost, namespaced to avoid system conflicts.
|
|
2 | 2015-01-30 | world_canvas_server |
Storage manager and server for WCF semantic maps.
Storage manager and server for WCF semantic maps.
|
|
1 | 2015-01-29 | libfreenect |
Open source libraries that will enable the Kinect to be used with Windows, Linux, and Mac.
Open source libraries that will enable the Kinect to be used with Windows, Linux, and Mac.
|
|
1 | 2015-01-26 | utilrb |
Ruby toolkit: This library is a collection of useful Ruby classes
Ruby toolkit: This library is a collection of useful Ruby classes
|
|
1 | 2015-01-26 | typelib |
This library offers an introspection mechanism for C/C++ value-types. I.e.
it offers a way to represent types, and to manipulate in-memory values
that are instances of those types.
A Ruby binding is included, which gives a fast and transparent
modification of C/C++ in-memory types from Ruby.
This library offers an introspection mechanism for C/C++ value-types. I.e.
it offers a way to represent types, and to manipulate in-memory values
that are instances of those types.
A Ruby binding is included, which gives a fast and transparent
modification of C/C++ in-memory types from Ruby.
|
|
1 | 2015-01-21 | jackal_simulator |
Packages for simulating Jackal.
Packages for simulating Jackal.
|
|
1 | 2015-01-21 | jackal_gazebo |
Launchfiles to use Jackal in Gazebo.
Launchfiles to use Jackal in Gazebo.
|
|
1 | 2015-01-20 | innok_heros_lights |
ROS driver for LED lights installed on Innok Heros
ROS driver for LED lights installed on Innok Heros
|
|
2 | 2015-01-19 | pr2_mechanism_model |
|
|
2 | 2015-01-19 | pr2_mechanism_diagnostics |
The `pr2_mechanism_diagnostics` node subscribes to `mechanism_statistics` and publishes diagnostics data for joints and controllers on `/diagnostics`.
The `pr2_mechanism_diagnostics` node subscribes to `mechanism_statistics` and publishes diagnostics data for joints and controllers on `/diagnostics`.
|
|
2 | 2015-01-19 | pr2_mechanism |
The pr2_mechanism stack contains the infrastructure to control the PR2 robot in a hard realtime control loop.
The pr2_mechanism stack contains the infrastructure to control the PR2 robot in a hard realtime control loop.
|
|
2 | 2015-01-19 | pr2_hardware_interface |
This package contains the C++ interfaces to the PR2 hardware
components that are controlled over EtherCAT. This includes the
motors and encoders needed to control the PR2 mechanism, as well as
components like the pressure sensors in the fingertips, camera
triggers, etc... All of the hardware components in this interface are
directly available to the controllers inside the hard realtime
control loop.
This package contains the C++ interfaces to the PR2 hardware
components that are controlled over EtherCAT. This includes the
motors and encoders needed to control the PR2 mechanism, as well as
components like the pressure sensors in the fingertips, camera
triggers, etc... All of the hardware components in this interface are
directly available to the controllers inside the hard realtime
control loop.
|
|
2 | 2015-01-19 | pr2_controller_manager |
The controller manager (CM) package provides the infrastructure to run controllers in a hard realtime loop.
The controller manager (CM) package provides the infrastructure to run controllers in a hard realtime loop.
|
|
2 | 2015-01-19 | pr2_controller_interface |
This package specifies the interface to a realtime controller. A
controller that implements this interface can be executed by the
This package specifies the interface to a realtime controller. A
controller that implements this interface can be executed by the
|
|
1 | 2015-01-15 | kinect_aux |
A standalone driver for the Kinect accelerometers and tilt motor.
A standalone driver for the Kinect accelerometers and tilt motor.
|
|
1 | 2015-01-13 | ros_package_web_server |
Web server to host ROS package content
Web server to host ROS package content
|
|
2 | 2015-01-13 | pr2_power_drivers |
Power drivers for the PR2 robot.
Power drivers for the PR2 robot.
|
|
2 | 2015-01-13 | pr2_power_board |
This provides a ROS node for the PR2 Power Board.
This provides a ROS node for the PR2 Power Board.
|
|
2 | 2015-01-13 | power_monitor |
The power_monitor collects messages from the ocean_battery_server and
the pr2_power_board, and publishes a summary of their data in a
friendlier message format.
The power_monitor collects messages from the ocean_battery_server and
the pr2_power_board, and publishes a summary of their data in a
friendlier message format.
|
|
1 | 2015-01-13 | pcan_topics |
pcan topics is based on transmi- and receivetest. It consists of two nodes; pcan_transmit and pcan_receive. The pcan_transmit is subscribed to the pcan_transmit topic and sends a CAN message based on the string published. The pcan_receive publishes incomming CAN messages on the pcan_receive topic in string format.
pcan topics is based on transmi- and receivetest. It consists of two nodes; pcan_transmit and pcan_receive. The pcan_transmit is subscribed to the pcan_transmit topic and sends a CAN message based on the string published. The pcan_receive publishes incomming CAN messages on the pcan_receive topic in string format.
|
|
2 | 2015-01-13 | ocean_battery_driver |
This is an interface to the Ocean Server Technology Intelligent Battery and Power System.
This is an interface to the Ocean Server Technology Intelligent Battery and Power System.
|
|
1 | 2015-01-12 | ivcon |
Mesh Conversion Utility
Used to generate '.iv' files from '.stl' files. This package has not
been changed since 2001 and appears to be very stable. We plan on
keeping this package in this revision for mesh conversions. This
package is only available as a single source file for download. There
are no local modifications to this package.
Mesh Conversion Utility
Used to generate '.iv' files from '.stl' files. This package has not
been changed since 2001 and appears to be very stable. We plan on
keeping this package in this revision for mesh conversions. This
package is only available as a single source file for download. There
are no local modifications to this package.
|
|
1 | 2015-01-07 | myo_ros |
The myo_ros package
The myo_ros package
|
|
1 | 2015-01-06 | convex_decomposition |
Convex Decomposition Tool for Robot Model
Convex Decomposition Tool for Robot Model
|
|
1 | 2014-12-31 | kinect_2d_scanner |
Kinect grabber as 2D laser scans
Kinect grabber as 2D laser scans
|
|
1 | 2014-12-23 | grizzly_simulator |
Metapackage allowing easy installation of Grizzly simulation components.
Metapackage allowing easy installation of Grizzly simulation components.
|
|
1 | 2014-12-23 | grizzly_gazebo_plugins |
Gazebo plugin to provide simulated Grizzly dynamics.
Gazebo plugin to provide simulated Grizzly dynamics.
|
|
1 | 2014-12-23 | grizzly_gazebo |
Example launchfiles for working with the Grizzly simulator.
Example launchfiles for working with the Grizzly simulator.
|
|
1 | 2014-12-23 | cmake_modules |
A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.
A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.
|
|
1 | 2014-12-18 | grizzly_viz |
Visualization and rviz helpers for Grizzly
Visualization and rviz helpers for Grizzly
|
|
1 | 2014-12-18 | grizzly_desktop |
Metapackage of things you want to visualize and control Grizzly from a desktop.
Metapackage of things you want to visualize and control Grizzly from a desktop.
|
|
1 | 2014-12-16 | swiftnav |
ROS release of swiftnav library
ROS release of swiftnav library
|
|
1 | 2014-12-16 | 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.
|
|
1 | 2014-12-11 | lsd_slam_viewer |
3D Viewer for LSD-SLAM.
3D Viewer for LSD-SLAM.
|
|
1 | 2014-12-11 | lsd_slam_core |
Large-Scale Direct Monocular SLAM
Large-Scale Direct Monocular SLAM
|
|
1 | 2014-12-09 | ola_ros |
This package contains ROS wrappers of OLA functionality
This package contains ROS wrappers of OLA functionality
|
|
1 | 2014-12-09 | lighting_tools |
Utilities for common lighting devices
Utilities for common lighting devices
|
|
1 | 2014-12-09 | lighting_msgs |
The lighting_msgs package
The lighting_msgs package
|
|
1 | 2014-12-04 | yujin_maps |
The yujin_maps package
The yujin_maps package
|
|
1 | 2014-12-02 | kingfisher_msgs |
Provides standard messages specific to Kingfisher, especially for
the microcontroller's rosserial interface.
Provides standard messages specific to Kingfisher, especially for
the microcontroller's rosserial interface.
|
|
1 | 2014-12-02 | kingfisher_description |
URDF description for Kingfisher
URDF description for Kingfisher
|
|
2 | 2014-11-28 | world_canvas_msgs |
World canvas framework messages package
World canvas framework messages package
|
|
1 | 2014-11-11 | head_pose_estimation |
ROS wrapper around Fanelli et al.'s Real Time Head Pose Estimation from Consumer Depth Cameras. 33rd Annual Symposium of the German Association for Pattern Recognition (DAGM'11), 2011.
ROS wrapper around Fanelli et al.'s Real Time Head Pose Estimation from Consumer Depth Cameras. 33rd Annual Symposium of the German Association for Pattern Recognition (DAGM'11), 2011.
|
|
1 | 2014-11-04 | rtt_typelib |
Orocos/RTT typelib bindings
Orocos/RTT typelib bindings
|
|
1 | 2014-11-03 | robot_web_tools |
Robot Web Tools Metapackage and Top Level Launch Files
Robot Web Tools Metapackage and Top Level Launch Files
|
|
1 | 2014-10-30 | ros_web_video |
Streaming of ROS Image Topics via HTTP
Streaming of ROS Image Topics via HTTP
|
|
1 | 2014-10-30 | mjpeg_server |
A ROS Node to Stream Image Topics Via a MJPEG Server
A ROS Node to Stream Image Topics Via a MJPEG Server
|
|
1 | 2014-10-17 | rqt_graphprofiler |
An experimental visualization system for anonymous publish subscribe architectures.
An experimental visualization system for anonymous publish subscribe architectures.
|
|
1 | 2014-10-12 | cpp_introspection |
cpp_introspection enables introspection of ROS message types in roscpp.
Introspection is useful when message data is going to be exported to or imported from
other data formats or applications.
cpp_introspection enables introspection of ROS message types in roscpp.
Introspection is useful when message data is going to be exported to or imported from
other data formats or applications.
|
|
1 | 2014-10-09 | rosprofiler |
The rosprofiler package provides the rosprofiler and rosgrapher tools.
These tools run as nodes publishing their collected information on ros topics.
They have been designed to work with the Topic Statistics feature found
in ROS Indigo to provide a complete picture of a ROS System.
The rosprofiler package provides the rosprofiler and rosgrapher tools.
These tools run as nodes publishing their collected information on ros topics.
They have been designed to work with the Topic Statistics feature found
in ROS Indigo to provide a complete picture of a ROS System.
|
|
1 | 2014-09-21 | uwsim_bullet |
The bullet library. See https://code.google.com/p/bullet
The bullet library. See https://code.google.com/p/bullet
|
|
3 | 2014-09-16 | ml_classifiers |
ml_classifiers
ml_classifiers
|
|
1 | 2014-09-15 | xv_11_laser_driver |
Neato XV-11 Laser Driver. This driver works with the laser when it is removed from the XV-11 Robot as opposed to reading scans from the Neato's USB port.
Neato XV-11 Laser Driver. This driver works with the laser when it is removed from the XV-11 Robot as opposed to reading scans from the Neato's USB port.
|
|
1 | 2014-09-13 | nav2_platform |
ROS stack containing all nodes, config, and launch files for Nav2 mobile robotics platform.
ROS stack containing all nodes, config, and launch files for Nav2 mobile robotics platform.
|
|
1 | 2014-09-13 | nav2_navigation |
ROS navigation config and launch files for Nav2 Robot Platform
ROS navigation config and launch files for Nav2 Robot Platform
|
|
1 | 2014-09-13 | nav2_driver |
ROS driver node for the Nav2 base
ROS driver node for the Nav2 base
|
|
2 | 2014-09-13 | nav2_bringup |
ROS launch files for Nav2 Robot Platform bringup
ROS launch files for Nav2 Robot Platform bringup
|
|
1 | 2014-09-04 | libvimba |
The libvimba package
The libvimba package
|
|
1 | 2014-08-22 | rosh_visualization |
ROSH plugin for the visualization stack.
ROSH plugin for the visualization stack.
|
|
1 | 2014-08-22 | rosh_desktop_plugins |
ROSH plugins related to the desktop variant.
ROSH plugins related to the desktop variant.
|
|
1 | 2014-08-22 | rosh_desktop |
ROSH meta-plugin for the ROS 'desktop' variant.
ROSH meta-plugin for the ROS 'desktop' variant.
|
|
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 | 2014-08-17 | rosh_robot_plugins |
ROSH related packages. This is a temporary stack that is expected to go away after the Diamondback release. For C Turtle and Diamondback it provides a convenient way to install rosh until it is properly stabilized.
ROSH related packages. This is a temporary stack that is expected to go away after the Diamondback release. For C Turtle and Diamondback it provides a convenient way to install rosh until it is properly stabilized.
|
|
1 | 2014-08-17 | rosh_robot |
ROSH meta-plugin for the ROS 'robot' variant.
ROSH meta-plugin for the ROS 'robot' variant.
|
|
1 | 2014-08-17 | rosh_geometry |
ROSH plugin for the geometry stack, including tf.
ROSH plugin for the geometry stack, including tf.
|
|
1 | 2014-08-17 | rosh_common |
ROSH plugin for packages in the common stack
ROSH plugin for packages in the common stack
|
|
1 | 2014-08-11 | kobuki_msgs |
|
|
1 | 2014-08-08 | sbpl |
Search-based planning library (SBPL).
Search-based planning library (SBPL).
|
|
1 | 2014-08-06 | python-aniso8601 |
Another ISO 8601 parser for Python
Another ISO 8601 parser for Python
|
|
1 | 2014-07-28 | prosilica_gige_sdk |
AVT GigE SDK version 1.26 for ROS
AVT GigE SDK version 1.26 for ROS
|
|
1 | 2014-07-03 | zeroconf_msgs |
General ros communications used by the various zeroconf implementations.
General ros communications used by the various zeroconf implementations.
|
|
1 | 2014-07-02 | threemxl |
Dynamixel and 3mxl driver
Dynamixel and 3mxl driver
|
|
1 | 2014-07-02 | shared_serial |
Shared serial port with locking functionality
Shared serial port with locking functionality
|
|
1 | 2014-06-09 | interactive_marker_proxy |
A Proxy Server for Interactive Markers
A Proxy Server for Interactive Markers
|
|
1 | 2014-06-02 | hokuyo_node |
A ROS node to provide access to SCIP 2.0-compliant Hokuyo laser range finders (including 04LX).
A ROS node to provide access to SCIP 2.0-compliant Hokuyo laser range finders (including 04LX).
|
|
1 | 2014-05-30 | razer_hydra |
Unofficial driver and ROS node for Razer Hydra
Unofficial driver and ROS node for Razer Hydra
|
|
1 | 2014-05-28 | concert_simple_scheduler |
This ROS package provides a simple, experimental, resource
scheduler for the Robotics in Concert project.
This ROS package provides a simple, experimental, resource
scheduler for the Robotics in Concert project.
|
|
1 | 2014-05-28 | concert_scheduling |
ROCON scheduler support packages.
ROCON scheduler support packages.
|
|
1 | 2014-05-28 | concert_scheduler_requests |
Python interfaces for managing ROCON scheduler requests.
Python interfaces for managing ROCON scheduler requests.
|
|
1 | 2014-05-28 | concert_resource_pool |
Python interfaces for managing a pool of ROCON scheduler resources.
Python interfaces for managing a pool of ROCON scheduler resources.
|
|
1 | 2014-05-21 | rqt_capabilities |
rqt package for visualization and management of capabilities
rqt package for visualization and management of capabilities
|
|
1 | 2014-05-15 | interaction_cursor_rviz |
An Rviz plugin that implements the interaction_cursor_msgs API
to interact with interactive_markers.
An Rviz plugin that implements the interaction_cursor_msgs API
to interact with interactive_markers.
|
|
1 | 2014-05-15 | interaction_cursor_msgs |
A message API for implementing a 6-DOF interaction cursor.
A minimal implementation has one node that handles the user device I/O and
another node (e.g. a plugin in Rviz) that uses the messages to interact with
a marker.
A message API for implementing a 6-DOF interaction cursor.
A minimal implementation has one node that handles the user device I/O and
another node (e.g. a plugin in Rviz) that uses the messages to interact with
a marker.
|
|
1 | 2014-05-15 | interaction_cursor_demo |
A demo 3D cursor interaction application.
A demo 3D cursor interaction application.
|
|
1 | 2014-05-15 | interaction_cursor_3d |
Metapackage for interaction cursor functionality.
Metapackage for interaction cursor functionality.
|
|
1 | 2014-05-14 | rviz_fixed_view_controller |
A simple rviz view controller that follows a TF frame.
A simple rviz view controller that follows a TF frame.
|
|
1 | 2014-05-12 | tum_ardrone |
The tum_ardrone package
The tum_ardrone package
|
|
1 | 2014-05-11 | object_recognition_msgs |
Object_recognition_msgs contains the ROS message and the actionlib definition used in object_recognition_core
Object_recognition_msgs contains the ROS message and the actionlib definition used in object_recognition_core
|
|
1 | 2014-05-10 | crsm_slam |
ROS package for the CRSM SLAM (Critical Rays Scan Match Simultaneous Localization And Mapping)
ROS package for the CRSM SLAM (Critical Rays Scan Match Simultaneous Localization And Mapping)
|
|
1 | 2014-05-09 | kurt_navigation_slam |
This package holds launch files for running the
This package holds launch files for running the
|
|
1 | 2014-05-09 | kurt_navigation_local |
This package holds xml files for running the
This package holds xml files for running the
|
|
1 | 2014-05-09 | kurt_navigation_global |
This package holds XML files for running the
This package holds XML files for running the
|
|
1 | 2014-05-09 | kurt_navigation_config |
This package holds common configuration files for running the
This package holds common configuration files for running the
|
|
1 | 2014-05-09 | kurt_2dnav_slam |
This application allows the Kurt to navigate autonomously while also
building a map of its environment as it drives along. It is modeled after
pr2_2dnav_slam.
This application allows the Kurt to navigate autonomously while also
building a map of its environment as it drives along. It is modeled after
pr2_2dnav_slam.
|
|
1 | 2014-05-09 | kurt_2dnav |
This application allows the Kurt robot to navigate autonomously with a
pre-specified static map. This package is modeled after pr2_2dnav.
This application allows the Kurt robot to navigate autonomously with a
pre-specified static map. This package is modeled after pr2_2dnav.
|
|
1 | 2014-05-07 | enu |
enu
enu
|
|
1 | 2014-05-06 | uwsim_osgworks |
The OSG Works library adapted to UWSim. See https://code.google.com/p/osgworks
The OSG Works library adapted to UWSim. See https://code.google.com/p/osgworks
|
|
1 | 2014-05-05 | std_capabilities |
This package contains standard capability interfaces, which describe common robot capabilities in terms of ROS concepts such as topics, services, actions, and parameters.
This package contains standard capability interfaces, which describe common robot capabilities in terms of ROS concepts such as topics, services, actions, and parameters.
|
|
1 | 2014-05-02 | uwsim_osgbullet |
The OSG Bullet library adapted to UWSim. See https://code.google.com/p/osgbullet
The OSG Bullet library adapted to UWSim. See https://code.google.com/p/osgbullet
|
|
1 | 2014-04-23 | sql_database |
Provides an easy to use and general interface between a SQL
database and object-oriented C++ code, making it easy to
encapsulate the conceptual "objects" contained in the database as
C++ classes.
Provides an easy to use and general interface between a SQL
database and object-oriented C++ code, making it easy to
encapsulate the conceptual "objects" contained in the database as
C++ classes.
|
|
2 | 2014-04-21 | rtctree |
|
|
1 | 2014-04-17 | octomap_ros |
octomap_ros provides conversion functions between ROS and OctoMap's native types.
This enables a convenvient use of the octomap package in ROS.
octomap_ros provides conversion functions between ROS and OctoMap's native types.
This enables a convenvient use of the octomap package in ROS.
|
|
1 | 2014-03-31 | axcli |
A simple actionlib CLI client
A simple actionlib CLI client
|
|
1 | 2014-03-25 | media_export |
Placeholder package enabling generic export of media paths.
Placeholder package enabling generic export of media paths.
|
|
1 | 2014-02-28 | household_objects_database |
Class definitions and a few convenience functions for interfacing
with a specific SQL database, containing 3D models of a set of
common household objects.
Class definitions and a few convenience functions for interfacing
with a specific SQL database, containing 3D models of a set of
common household objects.
|
|
1 | 2014-02-21 | youbot_simulation |
Packages to run the KUKA youBot in the Gazebo simulation with ROS
Packages to run the KUKA youBot in the Gazebo simulation with ROS
|
|
1 | 2014-02-21 | youbot_gazebo_worlds |
Gazebo worlds configurations
Gazebo worlds configurations
|
|
1 | 2014-02-21 | youbot_gazebo_robot |
Launch the KUKA youBot in the Gazebo simulation
Launch the KUKA youBot in the Gazebo simulation
|
|
1 | 2014-02-21 | youbot_gazebo_control |
Controller
Controller
|
|
1 | 2014-01-16 | humanoid_nav_msgs |
Messages and services for humanoid robot navigation
Messages and services for humanoid robot navigation
|
|
1 | 2014-01-16 | humanoid_msgs |
Messages and services for humanoid robots
Messages and services for humanoid robots
|
|
1 | 2013-12-10 | libsegwayrmp |
This is a C++ library for interfacing with Segway's RMP line of robotic platforms.
This is a C++ library for interfacing with Segway's RMP line of robotic platforms.
|
|
1 | 2013-11-08 | shape_tools |
Tools for operating on shape messages.
Tools for operating on shape messages.
|
|
1 | 2013-09-19 | ax2550 |
Package which provides a library and a ROS ndoe for interfacing with the Roboteq AX2550 motor controller.
Package which provides a library and a ROS ndoe for interfacing with the Roboteq AX2550 motor controller.
|
|
1 | 2013-09-18 | serial_utils |
A package which adds useful additions to the serial package.
A package which adds useful additions to the serial package.
|
|
1 | 2013-08-21 | message_runtime |
Package modeling the run-time dependencies for language bindings of messages.
Package modeling the run-time dependencies for language bindings of messages.
|
|
1 | 2013-08-21 | message_generation |
Package modeling the build-time dependencies for generating language bindings of messages.
Package modeling the build-time dependencies for generating language bindings of messages.
|
|
1 | 2013-08-16 | simple_navigation_goals_tutorial |
The simple_navigation_goals_tutorial package
The simple_navigation_goals_tutorial package
|
|
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 | 2013-08-16 | roomba_stage |
The roomba_stage package
The roomba_stage package
|
|
1 | 2013-08-16 | robot_setup_tf_tutorial |
The robot_setup_tf_tutorial package
The robot_setup_tf_tutorial package
|
|
1 | 2013-08-16 | point_cloud_publisher_tutorial |
The point_cloud_publisher_tutorial package
The point_cloud_publisher_tutorial package
|
|
1 | 2013-08-16 | odometry_publisher_tutorial |
The odometry_publisher_tutorial package
The odometry_publisher_tutorial package
|
|
1 | 2013-08-16 | navigation_tutorials |
Navigation related tutorials.
Navigation related tutorials.
|
|
1 | 2013-08-16 | navigation_stage |
This package holds example launch files for running the ROS navigation stack in stage.
This package holds example launch files for running the ROS navigation stack in stage.
|
|
1 | 2013-08-16 | laser_scan_publisher_tutorial |
The laser_scan_publisher_tutorial package
The laser_scan_publisher_tutorial package
|
|
1 | 2013-08-14 | map_store |
Storage manager for OccupancyGrid maps. Supports naming the most
recent map, getting a list of map names, and publishing a
specific map.
Storage manager for OccupancyGrid maps. Supports naming the most
recent map, getting a list of map names, and publishing a
specific map.
|
|
2 | 2013-07-17 | hector_quadrotor_demo |
hector_quadrotor_demo contains various launch files and needed dependencies for demonstration of the hector_quadrotor stack (indoor/outdoor flight in gazebo etc.)
hector_quadrotor_demo contains various launch files and needed dependencies for demonstration of the hector_quadrotor stack (indoor/outdoor flight in gazebo etc.)
|
|
2 | 2013-06-07 | map_msgs |
This package defines messages commonly used in mapping packages.
This package defines messages commonly used in mapping packages.
|
|
2 | 2013-04-26 | pr2_mechanism_msgs |
This package defines services that are used to communicate with
the realtime control loop. It also defines messages
that represent the state of the realtime controllers, the joints
and the actuators.
This package defines services that are used to communicate with
the realtime control loop. It also defines messages
that represent the state of the realtime controllers, the joints
and the actuators.
|
|
2 | 2010-06-01 | rtsprofile |
|
|
1 | zstd_vendor | |||
1 | zstd_point_cloud_transport | |||
1 | zstd_image_transport | |||
1 | zmqpp_vendor | |||
1 | zlib_point_cloud_transport | |||
1 | zivid_samples | |||
1 | zivid_interfaces | |||
1 | zivid_camera | |||
1 | zenoh_c_vendor | |||
1 | zenoh_bridge_dds | |||
1 | zed_msgs | |||
1 | zbar_ros_interfaces | |||
1 | z_laser_zlp1 | |||
1 | z_laser_viz | |||
1 | z_laser_projector | |||
1 | z_laser_msgs | |||
1 | z_laser_gui | |||
1 | yujin_yrl_package | |||
1 | yosemite_valley | |||
1 | yoctopuce_altimeter | |||
1 | yocs_navi_toolkit | |||
1 | yocs_msgs | |||
1 | yaml_cpp_vendor | |||
1 | xsens_mti_driver | |||
0 | xsdcxx | |||
1 | xiaoqiang_server | |||
1 | xiaoqiang_navigation_example | |||
1 | xiaoqiang_navigation | |||
1 | xiaoqiang_msgs | |||
1 | xiaoqiang_monitor | |||
1 | xiaoqiang_freenect_launch | |||
1 | xiaoqiang_freenect_camera | |||
1 | xiaoqiang_freenect | |||
1 | xiaoqiang_driver | |||
1 | xiaoqiang_description | |||
1 | xiaoqiang_depth_image_proc | |||
1 | xiaoqiang_controller | |||
1 | xiaoqiang_bringup | |||
1 | xiaoqiang | |||
1 | xbot_tools |
Packages
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2017-09-18 | roch_simulator |
Metapackage for SawYer roch simulation software
Metapackage for SawYer roch simulation software
|
|
1 | 2017-09-18 | roch_gazebo |
SawYer roch Simulator bringup
SawYer roch Simulator bringup
|
|
1 | 2017-08-31 | ros1_template_msgs |
Template ROS messages for use with catkin following good practices
Template ROS messages for use with catkin following good practices
|
|
1 | 2017-08-31 | ros1_template |
Template ROS node for use with catkin following good practices
Template ROS node for use with catkin following good practices
|
|
1 | 2017-08-31 | ros1_ros_cpptemplate |
C++ ROS project template following good practices
C++ ROS project template following good practices
|
|
1 | 2017-08-31 | ros1_pytemplate |
Python Template ROS node for use with catkin following good practices
Python Template ROS node for use with catkin following good practices
|
|
1 | 2017-08-31 | ros1_pip_pytemplate |
Template ROS node for use with catkin_pip following good practices
Template ROS node for use with catkin_pip following good practices
|
|
1 | 2017-08-31 | ros1_cpptemplate |
C++ project template with ROS logging following good practices
C++ project template with ROS logging following good practices
|
|
1 | 2017-08-29 | asr_mild_base_laserscanner |
This package provides streams of laser scan messages in cartesian coordinates from a planar sick laser scanner.
This package provides streams of laser scan messages in cartesian coordinates from a planar sick laser scanner.
|
|
1 | 2017-08-28 | myahrs_driver |
myahrs_driver is a driver package for the WITHROBOT's myAHRS+. The myAHRS+ is a low cost high performance AHRS(Attitude Heading Reference System) with USB/UART/I2C interface. The myAHRS+ board contains a 3-axis 16-bit gyroscope, a 3-axis 16-bit accelerometer and a 3-axis 13-bit magnetometer. The driver should also work with USB port.
myahrs_driver is a driver package for the WITHROBOT's myAHRS+. The myAHRS+ is a low cost high performance AHRS(Attitude Heading Reference System) with USB/UART/I2C interface. The myAHRS+ board contains a 3-axis 16-bit gyroscope, a 3-axis 16-bit accelerometer and a 3-axis 13-bit magnetometer. The driver should also work with USB port.
|
|
1 | 2017-08-25 | muse_bldc_motor_drive |
The muse_bldc_motor_drive package
The muse_bldc_motor_drive package
|
|
1 | 2017-08-22 | asr_resources_for_vision |
This package holds bits and pieces that are related to the acquisition of color and depth-image data streams with robot heads.
Currently, it contains a hierarchy of launch scripts to start up simultaneous data acquisition from complex setups of vision sensors as encountered on robot heads
(e.g. RGB-D in combination with a color camera or a stereo camera setup).
This package holds bits and pieces that are related to the acquisition of color and depth-image data streams with robot heads.
Currently, it contains a hierarchy of launch scripts to start up simultaneous data acquisition from complex setups of vision sensors as encountered on robot heads
(e.g. RGB-D in combination with a color camera or a stereo camera setup).
|
|
1 | 2017-08-14 | prosilica_camera |
A ROS driver node for AVT/Prosilica Gigabit Ethernet (GigE) cameras.
A ROS driver node for AVT/Prosilica Gigabit Ethernet (GigE) cameras.
|
|
1 | 2017-08-09 | frontier_exploration |
Implementation of
Implementation of
|
|
1 | 2017-08-08 | hugin_panorama |
Create panoramas in ROS using image snapshots or multiple video streams.
Create panoramas in ROS using image snapshots or multiple video streams.
|
|
1 | 2017-08-07 | turtle_tf2 |
turtle_tf2 demonstrates how to write a tf2 broadcaster and listener with the turtlesim. The tutle_tf2_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
turtle_tf2 demonstrates how to write a tf2 broadcaster and listener with the turtlesim. The tutle_tf2_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
|
|
1 | 2017-08-07 | turtle_tf |
turtle_tf demonstrates how to write a tf broadcaster and listener with the turtlesim. The tutle_tf_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
turtle_tf demonstrates how to write a tf broadcaster and listener with the turtlesim. The tutle_tf_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
|
|
1 | 2017-08-07 | geometry_tutorials |
Metapackage of geometry tutorials ROS.
Metapackage of geometry tutorials ROS.
|
|
1 | 2017-08-07 | fzi_icl_core |
The fzi_icl_core package
The fzi_icl_core package
|
|
1 | 2017-08-06 | sophus_ros_conversions |
Conversions between ros and sophus.
Conversions between ros and sophus.
|
|
1 | 2017-08-05 | lost_comms_recovery |
If your robot loses connection to the base station it will stop motors or navigate home.
If your robot loses connection to the base station it will stop motors or navigate home.
|
|
1 | 2017-08-05 | image_overlay_scale_and_compass |
Add an indication of scale and compass to images and video streams.
Add an indication of scale and compass to images and video streams.
|
|
2 | 2017-07-26 | urdfdom_py |
Python implementation of the URDF parser.
Python implementation of the URDF parser.
|
|
1 | 2017-07-21 | uwsim |
UWSim is an UnderWater SIMulator for marine robotics research and development. UWSim visualizes an underwater virtual scenario that can be configured using standard modeling software. Controllable underwater vehicles, surface vessels and robotic manipulators, as well as simulated sensors, can be added to the scene and accessed externally through ROS interfaces. This allows to easily integrate the visualization tool with existing control architectures.
UWSim is an UnderWater SIMulator for marine robotics research and development. UWSim visualizes an underwater virtual scenario that can be configured using standard modeling software. Controllable underwater vehicles, surface vessels and robotic manipulators, as well as simulated sensors, can be added to the scene and accessed externally through ROS interfaces. This allows to easily integrate the visualization tool with existing control architectures.
|
|
1 | 2017-07-21 | underwater_vehicle_dynamics |
An underwater dynamics module
An underwater dynamics module
|
|
1 | 2017-07-21 | underwater_sensor_msgs |
Common messages for underwater robotics
Common messages for underwater robotics
|
|
1 | 2017-07-20 | asr_robot |
Packages to control and visualize our robot. Includes packages you can use for drives your robot.
Packages to control and visualize our robot. Includes packages you can use for drives your robot.
|
|
1 | 2017-07-18 | tiny_slam |
TinySLAM ROS implementation
TinySLAM ROS implementation
|
|
1 | 2017-07-12 | vigir_footstep_planning_widgets |
The vigir_footstep_planning_widgets package
The vigir_footstep_planning_widgets package
|
|
1 | 2017-07-12 | vigir_footstep_planning_rviz_plugin |
The vigir_footstep_planning_rviz_plugin package
The vigir_footstep_planning_rviz_plugin package
|
|
1 | 2017-07-12 | vigir_footstep_planning_plugins |
The vigir_footstep_planning_plugins package
The vigir_footstep_planning_plugins package
|
|
1 | 2017-07-12 | vigir_footstep_planning_lib |
The vigir_footstep_planning_lib package
The vigir_footstep_planning_lib package
|
|
1 | 2017-07-07 | wiimote |
The wiimote package allows ROS nodes to communicate with a Nintendo Wiimote
and its related peripherals, including the Nunchuk, Motion Plus, and
(experimentally) the Classic. The package implements a ROS node that uses
Bluetooth to communicate with the Wiimote device, obtaining accelerometer
and gyro data, the state of LEDs, the IR camera, rumble (vibrator),
buttons, joystick, and battery state. The node additionally enables ROS
nodes to control the Wiimote's LEDs and vibration for feedback to the human
Wiimote operator. LEDs and vibration may be switched on and off, or made to
operate according to a timed pattern.
The wiimote package allows ROS nodes to communicate with a Nintendo Wiimote
and its related peripherals, including the Nunchuk, Motion Plus, and
(experimentally) the Classic. The package implements a ROS node that uses
Bluetooth to communicate with the Wiimote device, obtaining accelerometer
and gyro data, the state of LEDs, the IR camera, rumble (vibrator),
buttons, joystick, and battery state. The node additionally enables ROS
nodes to control the Wiimote's LEDs and vibration for feedback to the human
Wiimote operator. LEDs and vibration may be switched on and off, or made to
operate according to a timed pattern.
|
|
1 | 2017-07-07 | spacenav_node |
ROS interface to the 3Dconnexion SpaceNavigator 6DOF joystick.
ROS interface to the 3Dconnexion SpaceNavigator 6DOF joystick.
|
|
1 | 2017-07-07 | ps3joy |
Playstation 3 SIXAXIS or DUAL SHOCK 3 joystick driver.
Driver for the Sony PlayStation 3 SIXAXIS or DUAL SHOCK 3
joysticks. In its current state, this driver is not compatible
with the use of other Bluetooth HID devices. The driver listens
for a connection on the HID ports, starts the joystick
streaming data, and passes the data to the Linux uinput device
so that it shows up as a normal joystick.
Playstation 3 SIXAXIS or DUAL SHOCK 3 joystick driver.
Driver for the Sony PlayStation 3 SIXAXIS or DUAL SHOCK 3
joysticks. In its current state, this driver is not compatible
with the use of other Bluetooth HID devices. The driver listens
for a connection on the HID ports, starts the joystick
streaming data, and passes the data to the Linux uinput device
so that it shows up as a normal joystick.
|
|
1 | 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 | 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 | 2017-06-30 | look_at_pose |
Rotate camera to look at a given pose.
Rotate camera to look at a given pose.
|
|
1 | 2017-06-27 | asr_sick_lms_400 |
This package is used to access the sick lms400 laser range-finder. It contains all necessary functionality to communicate with the sensor via rosmessages.
This package is used to access the sick lms400 laser range-finder. It contains all necessary functionality to communicate with the sensor via rosmessages.
|
|
1 | 2017-06-27 | asr_rviz_pose_manager |
This package is used to get poses from Rviz by using the goal tool and to store them in an XML-file
This package is used to get poses from Rviz by using the goal tool and to store them in an XML-file
|
|
1 | 2017-06-27 | asr_mild_base_launch_files |
This package contains the launch files and different documents needed to start the system
This package contains the launch files and different documents needed to start the system
|
|
1 | 2017-06-27 | asr_mild_base_driving |
This package calculates and publishes the odometry information, transforms the velocity command into differential drive commands and writes it on the mild_base_driving bus
This package calculates and publishes the odometry information, transforms the velocity command into differential drive commands and writes it on the mild_base_driving bus
|
|
1 | 2017-06-27 | asr_kinematic_chain_optimizer |
This package calculates the best approximation for a kinematic chain's parameters using rosenbrock optimization. For calculation, a layout of the kinematic chain must be provided, as well as a set of transformations between two frames of the chain that has been acquired during calibration.
This package calculates the best approximation for a kinematic chain's parameters using rosenbrock optimization. For calculation, a layout of the kinematic chain must be provided, as well as a set of transformations between two frames of the chain that has been acquired during calibration.
|
|
1 | 2017-06-27 | asr_kinematic_chain_dome |
This package provides information about the PbD dome's kinematic chain and contains launch-files to publish the chain to a robot_state_publisher. Available launchfiles are: dome with real PTU, dome with simulated PTU, dome with real PTU and Flock of Birds and additional transformation_publisher from guppy-cameras to the kinect cameras mounted above. It also contains the urdf model.
This package provides information about the PbD dome's kinematic chain and contains launch-files to publish the chain to a robot_state_publisher. Available launchfiles are: dome with real PTU, dome with simulated PTU, dome with real PTU and Flock of Birds and additional transformation_publisher from guppy-cameras to the kinect cameras mounted above. It also contains the urdf model.
|
|
1 | 2017-06-27 | asr_ivt_bridge |
This package is used to convert between ROS messages and IVT images
This package is used to convert between ROS messages and IVT images
|
|
1 | 2017-06-27 | asr_flock_of_birds |
The asr_flock_of_birds package is the driver for Ascension Technology Corp magnet-tracking system "Flock of Birds". It provides the remote server which publishes two 6d posemarker and the nessesary TF from the magnettracking system. It also contains launchfiles and calibration tools for the use of it.
The asr_flock_of_birds package is the driver for Ascension Technology Corp magnet-tracking system "Flock of Birds". It provides the remote server which publishes two 6d posemarker and the nessesary TF from the magnettracking system. It also contains launchfiles and calibration tools for the use of it.
|
|
1 | 2017-06-27 | asr_cyberglove_visualization |
This package is used to test the functionalities of the CyberGloves and FlockOfBirds.
It uses an URDF model of a human hand to provide a visualization of the glove movements in RViz.
This package is used to test the functionalities of the CyberGloves and FlockOfBirds.
It uses an URDF model of a human hand to provide a visualization of the glove movements in RViz.
|
|
1 | 2017-06-27 | asr_cyberglove_lib |
This package is used to start a server that provides the current joint state values received from the CyberGloves via ROS topics
This package is used to start a server that provides the current joint state values received from the CyberGloves via ROS topics
|
|
1 | 2017-06-26 | ecl_utilities |
Includes various supporting tools and utilities for c++ programming.
Includes various supporting tools and utilities for c++ programming.
|
|
1 | 2017-06-26 | ecl_type_traits |
Extends c++ type traits and implements a few more to boot.
Extends c++ type traits and implements a few more to boot.
|
|
1 | 2017-06-26 | ecl_time |
Timing utilities are very dependent on the system api provided for their use.
This package provides a means for handling different timing models. Current support
- posix rt : complete.
- macosx : posix timers only, missing absolute timers.
- win : none.
Timing utilities are very dependent on the system api provided for their use.
This package provides a means for handling different timing models. Current support
- posix rt : complete.
- macosx : posix timers only, missing absolute timers.
- win : none.
|
|
1 | 2017-06-26 | ecl_threads |
This package provides the c++ extensions for a variety of threaded
programming tools. These are usually different on different
platforms, so the architecture for a cross-platform framework
is also implemented.
This package provides the c++ extensions for a variety of threaded
programming tools. These are usually different on different
platforms, so the architecture for a cross-platform framework
is also implemented.
|
|
1 | 2017-06-26 | ecl_streams |
These are lightweight text streaming classes that connect to standardised
ecl type devices.
These are lightweight text streaming classes that connect to standardised
ecl type devices.
|
|
1 | 2017-06-26 | ecl_statistics |
Common statistical structures and algorithms for control systems.
Common statistical structures and algorithms for control systems.
|
|
1 | 2017-06-26 | ecl_sigslots |
Provides a signal/slot mechanism (in the same vein as qt sigslots,
boost::signals etc for intra-process communication. These include
some improvements - they do not need a preprocessor, are fully type safe,
allow for simple connections via a posix style string identifier
and are multithread-safe.
Provides a signal/slot mechanism (in the same vein as qt sigslots,
boost::signals etc for intra-process communication. These include
some improvements - they do not need a preprocessor, are fully type safe,
allow for simple connections via a posix style string identifier
and are multithread-safe.
|
|
1 | 2017-06-26 | ecl_mpl |
Metaprogramming tools move alot of runtime calculations to be shifted to
compile time. This has only very elementary structures at this stage.
Metaprogramming tools move alot of runtime calculations to be shifted to
compile time. This has only very elementary structures at this stage.
|
|
1 | 2017-06-26 | ecl_math |
This package provides simple support to cmath, filling in holes
or redefining in a c++ formulation where desirable.
This package provides simple support to cmath, filling in holes
or redefining in a c++ formulation where desirable.
|
|
1 | 2017-06-26 | ecl_linear_algebra |
Ecl frontend to a linear matrix package (currently eigen).
Ecl frontend to a linear matrix package (currently eigen).
|
|
1 | 2017-06-26 | ecl_ipc |
Interprocess mechanisms vary greatly across platforms - sysv, posix, win32, there
are more than a few. This package provides an infrastructure to allow for developing
cross platform c++ wrappers around the lower level c api's that handle these
mechanisms. These make it not only easier to utilise such mechanisms, but allow it
to be done consistently across platforms.
Interprocess mechanisms vary greatly across platforms - sysv, posix, win32, there
are more than a few. This package provides an infrastructure to allow for developing
cross platform c++ wrappers around the lower level c api's that handle these
mechanisms. These make it not only easier to utilise such mechanisms, but allow it
to be done consistently across platforms.
|
|
1 | 2017-06-26 | ecl_geometry |
Any tools relating to mathematical geometry.
Primarily featuring polynomials and interpolations.
Any tools relating to mathematical geometry.
Primarily featuring polynomials and interpolations.
|
|
1 | 2017-06-26 | ecl_formatters |
The formatters here simply format various input types to a specified
text format. They can be used with most streaming types (including both
ecl and stl streams).
The formatters here simply format various input types to a specified
text format. They can be used with most streaming types (including both
ecl and stl streams).
|
|
1 | 2017-06-26 | ecl_filesystem |
Cross platform filesystem utilities (until c++11 makes its way in).
Cross platform filesystem utilities (until c++11 makes its way in).
|
|
1 | 2017-06-26 | ecl_exceptions |
Template based exceptions - these are simple and practical
and avoid the proliferation of exception types. Although not
syntatactically ideal, it is convenient and eminently practical.
Template based exceptions - these are simple and practical
and avoid the proliferation of exception types. Although not
syntatactically ideal, it is convenient and eminently practical.
|
|
1 | 2017-06-26 | ecl_eigen |
This provides an Eigen implementation for ecl's linear algebra.
This provides an Eigen implementation for ecl's linear algebra.
|
|
1 | 2017-06-26 | ecl_devices |
Provides an extensible and standardised framework for input-output devices.
Provides an extensible and standardised framework for input-output devices.
|
|
1 | 2017-06-26 | ecl_core_apps |
This includes a suite of programs demo'ing various aspects of the
ecl_core. It also includes various benchmarking and utility programs for
use primarily with embedded systems.
This includes a suite of programs demo'ing various aspects of the
ecl_core. It also includes various benchmarking and utility programs for
use primarily with embedded systems.
|
|
1 | 2017-06-26 | ecl_core |
A set of tools and interfaces extending the capabilities of c++ to
provide a lightweight, consistent interface with a focus for control
programming.
A set of tools and interfaces extending the capabilities of c++ to
provide a lightweight, consistent interface with a focus for control
programming.
|
|
1 | 2017-06-26 | ecl_converters |
Some fast/convenient type converters, mostly for char strings or strings.
These are not really fully fleshed out, alot of them could use the addition for
the whole range of fundamental types (e.g. all integers, not just int, unsigned int).
They will come as the need arises.
Some fast/convenient type converters, mostly for char strings or strings.
These are not really fully fleshed out, alot of them could use the addition for
the whole range of fundamental types (e.g. all integers, not just int, unsigned int).
They will come as the need arises.
|
|
1 | 2017-06-26 | ecl_containers |
The containers included here are intended to extend the stl containers.
In all cases, these implementations are designed to implement
c++ conveniences and safety where speed is not sacrificed.
Also includes techniques for memory debugging of common problems such
as buffer overruns.
The containers included here are intended to extend the stl containers.
In all cases, these implementations are designed to implement
c++ conveniences and safety where speed is not sacrificed.
Also includes techniques for memory debugging of common problems such
as buffer overruns.
|
|
1 | 2017-06-26 | ecl_concepts |
Introduces a compile time concept checking mechanism that can be used
most commonly to check for required functionality when passing
template arguments.
Introduces a compile time concept checking mechanism that can be used
most commonly to check for required functionality when passing
template arguments.
|
|
1 | 2017-06-26 | ecl_command_line |
Embeds the TCLAP library inside the ecl. This is a very convenient
command line parser in templatised c++.
Embeds the TCLAP library inside the ecl. This is a very convenient
command line parser in templatised c++.
|
|
2 | 2017-06-19 | cartographer_rviz |
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations. This package provides Cartographer's RViz integration.
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations. This package provides Cartographer's RViz integration.
|
|
2 | 2017-06-19 | cartographer_ros_msgs |
ROS messages for the cartographer_ros package.
ROS messages for the cartographer_ros package.
|
|
2 | 2017-06-19 | cartographer_ros |
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations. This package provides Cartographer's ROS integration.
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations. This package provides Cartographer's ROS integration.
|
|
2 | 2017-06-19 | cartographer |
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations.
Cartographer is a system that provides real-time simultaneous localization
and mapping (SLAM) in 2D and 3D across multiple platforms and sensor
configurations.
|
|
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 | 2017-06-12 | bin_pose_msgs |
The bin_pose_msgs package
The bin_pose_msgs package
|
|
1 | 2017-06-12 | bin_pose_emulator |
|
|
1 | 2017-06-08 | ps4eye |
The ps4eye package
The ps4eye package
|
|
1 | 2017-05-30 | rcll_fawkes_sim |
RCLL simulation access through Fawkes
RCLL simulation access through Fawkes
|
|
1 | 2017-05-17 | rcll_refbox_peer |
RCLL refbox communication adapter
RCLL refbox communication adapter
|
|
1 | 2017-05-06 | raspimouse_ros |
The raspimouse package
The raspimouse package
|
|
1 | 2017-05-05 | ros_peerjs |
ROS Peerjs package
ROS Peerjs package
|
|
1 | 2017-05-05 | oros_tools_examples |
The oros_tools_examples package
The oros_tools_examples package
|
|
2 | 2017-04-26 | pointcloud_to_laserscan |
Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).
Converts a 3D Point Cloud into a 2D laser scan. This is useful for making devices like the Kinect appear like a laser scanner for 2D-based algorithms (e.g. laser-based SLAM).
|
|
1 | 2017-04-21 | oros_tools |
Oros Tools is software suite that provide high
level functions to the web plateform Oros.
Oros Tools is software suite that provide high
level functions to the web plateform Oros.
|
|
1 | 2017-04-21 | log_server |
The log_server package
The log_server package
|
|
1 | 2017-04-17 | rgbd_launch |
Launch files to open an RGBD device and load all nodelets to
convert raw depth/RGB/IR streams to depth images, disparity images,
and (registered) point clouds.
Launch files to open an RGBD device and load all nodelets to
convert raw depth/RGB/IR streams to depth images, disparity images,
and (registered) point clouds.
|
|
1 | 2017-04-12 | bcap |
bCAP library as a ROS package
bCAP library as a ROS package
|
|
2 | 2017-04-03 | ackermann_controller |
The ackermann_controller package
The ackermann_controller 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-03-28 | romeo_description |
The romeo_description package
The romeo_description package
|
|
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-03-28 | eigen_stl_containers |
This package provides a set of typedef's that allow
using Eigen datatypes in STL containers
This package provides a set of typedef's that allow
using Eigen datatypes in STL containers
|
|
1 | 2017-03-22 | xv_11_laser_driver |
Neato XV-11 Laser Driver. This driver works with the laser when it is removed from the XV-11 Robot as opposed to reading scans from the Neato's USB port.
Neato XV-11 Laser Driver. This driver works with the laser when it is removed from the XV-11 Robot as opposed to reading scans from the Neato's USB port.
|
|
2 | 2017-03-21 | pyros_utils |
Miscellaneous tools for pyROS
Miscellaneous tools for pyROS
|
|
1 | 2017-03-21 | pyros_config |
Configuration package for Pyros
Configuration package for Pyros
|
|
1 | 2017-03-16 | filters |
This library provides a standardized interface for processing data as a sequence
of filters. This package contains a base class upon which to build specific implementations
as well as an interface which dynamically loads filters based on runtime parameters.
This library provides a standardized interface for processing data as a sequence
of filters. This package contains a base class upon which to build specific implementations
as well as an interface which dynamically loads filters based on runtime parameters.
|
|
1 | 2017-03-14 | sap_pkg |
sap_pkg
sap_pkg
|
|
1 | 2017-03-14 | saap_pkg |
sap_pkg
sap_pkg
|
|
1 | 2017-03-14 | k-sap_pkg |
sap_pkg
sap_pkg
|
|
1 | 2017-03-14 | k-saap_pkg |
sap_pkg
sap_pkg
|
|
1 | 2017-03-14 | auction_srvs |
auction_srvs
auction_srvs
|
|
1 | 2017-03-14 | auction_msgs |
auciton_msgs
auciton_msgs
|
|
1 | 2017-03-12 | rqt_wrapper |
A wrapper for keeping rqt programs alive.
A wrapper for keeping rqt programs alive.
|
|
1 | 2017-03-09 | vigir_pluginlib_msgs |
The vigir_pluginlib_msgs package
The vigir_pluginlib_msgs package
|
|
1 | 2017-03-09 | vigir_pluginlib_manager |
The vigir_pluginlib_manager package
The vigir_pluginlib_manager package
|
|
1 | 2017-03-09 | vigir_pluginlib |
The vigir_pluginlib package
The vigir_pluginlib package
|
|
1 | 2017-03-09 | tuw_marker_pose_estimation |
This node does pose estimation for detected fiducials (marker_msgs/FiducialDetection.msg)
This node does pose estimation for detected fiducials (marker_msgs/FiducialDetection.msg)
|
|
1 | 2017-03-09 | tuw_marker_detection |
The tuw_marker_detection package
The tuw_marker_detection package
|
|
1 | 2017-03-09 | tuw_ellipses |
The tuw_ellipses package contains a computer vision library which is able to detect ellipses within images.
The package is able to estimate the pose of the circle related to the ellipse the circle diameter as well as the camera parameter are known.
A dynamic reconfigure interface allows the user to tune the parameter of the system to ones needs.
But be aware that the pose of a projected circle within a image (ellipse) has two solutions and only one is published as TF.
The tuw_ellipses package contains a computer vision library which is able to detect ellipses within images.
The package is able to estimate the pose of the circle related to the ellipse the circle diameter as well as the camera parameter are known.
A dynamic reconfigure interface allows the user to tune the parameter of the system to ones needs.
But be aware that the pose of a projected circle within a image (ellipse) has two solutions and only one is published as TF.
|
|
1 | 2017-03-09 | tuw_checkerboard |
The tuw_checkerboard package is designed to detect one
checkerboard and to estimate the pose of the checkerboard relative to the camera.
The detection itself is based on the opencv functions for checkerboards.
The tuw_checkerboard package is designed to detect one
checkerboard and to estimate the pose of the checkerboard relative to the camera.
The detection itself is based on the opencv functions for checkerboards.
|
|
1 | 2017-03-09 | tuw_aruco |
This is a wrapper around the marker detection library ArUco.
This is a wrapper around the marker detection library ArUco.
|
|
1 | 2017-03-03 | task_compiler |
task_compiler
Compiler that translate task description in PDDL (Planning Domain Description Language) to SMACH (state machine based execution and coordination system) description.
task_compiler
Compiler that translate task description in PDDL (Planning Domain Description Language) to SMACH (state machine based execution and coordination system) description.
|
|
1 | 2017-03-03 | pddl_planner_viewer |
a viewer of pddl_planner.
a viewer of pddl_planner.
|
|
1 | 2017-03-03 | pddl_planner |
pddl planner wrappers
pddl planner wrappers
|
|
1 | 2017-03-03 | pddl_msgs |
message for pddl planner
message for pddl planner
|
|
1 | 2017-03-03 | jsk_planning |
|
|
1 | 2017-02-27 | smartek_camera |
Node for publishing frames from a Smartek camera
Node for publishing frames from a Smartek camera
|
|
1 | 2017-02-17 | pal_hardware_interfaces |
The pal_hardware_interfaces package
The pal_hardware_interfaces package
|
|
1 | 2017-02-16 | rcll_ros_msgs |
Message definitions for RCLL refbox communication
Message definitions for RCLL refbox communication
|
|
1 | 2017-02-06 | stdr_simulator |
A simple, flexible and scalable 2D multi-robot simulator.
A simple, flexible and scalable 2D multi-robot simulator.
|
|
1 | 2017-02-06 | stdr_server |
Implements synchronization and coordination functionalities of STDR Simulator.
Implements synchronization and coordination functionalities of STDR Simulator.
|
|
1 | 2017-02-06 | stdr_samples |
Provides sample codes to demonstrate STDR simulator functionalities.
Provides sample codes to demonstrate STDR simulator functionalities.
|
|
1 | 2017-02-06 | stdr_robot |
Provides robot, sensor implementation, using nodelets for stdr_server to load them.
Provides robot, sensor implementation, using nodelets for stdr_server to load them.
|
|
1 | 2017-02-06 | stdr_resources |
Provides robot and sensor descripiton files for STDR Simulator.
Provides robot and sensor descripiton files for STDR Simulator.
|
|
1 | 2017-02-06 | stdr_parser |
Provides a library to STDR Simulator, to parse yaml and xml description files.
Provides a library to STDR Simulator, to parse yaml and xml description files.
|
|
1 | 2017-02-06 | stdr_msgs |
Provides msgs, services and actions for STDR Simulator.
Provides msgs, services and actions for STDR Simulator.
|
|
1 | 2017-02-06 | stdr_launchers |
Launch files, to easily bringup server, robots, guis
Launch files, to easily bringup server, robots, guis
|
|
1 | 2017-02-06 | stdr_gui |
A gui in Qt for visualizing purposes in STDR Simulator.
A gui in Qt for visualizing purposes in STDR Simulator.
|
|
1 | 2017-02-05 | ecl_tools |
Tools and utilities for ecl development.
Tools and utilities for ecl development.
|
|
1 | 2017-02-05 | ecl_license |
Maintains the ecl licenses and also provides an install
target for deploying licenses with the ecl libraries.
Maintains the ecl licenses and also provides an install
target for deploying licenses with the ecl libraries.
|
|
1 | 2017-02-05 | ecl_build |
Collection of cmake/make build tools primarily for ecl development itself, but also
contains a few cmake modules useful outside of the ecl.
Collection of cmake/make build tools primarily for ecl development itself, but also
contains a few cmake modules useful outside of the ecl.
|
|
1 | 2017-02-02 | object_recognition_core |
object_recognition_core contains tools to launch several recognition pipelines, train objects, store models ...
object_recognition_core contains tools to launch several recognition pipelines, train objects, store models ...
|
|
1 | 2017-01-26 | rb_tracker |
Tracker of rigid bodies using visual features and/or shape-based poses (extensible to use other modalities as source of information)
Tracker of rigid bodies using visual features and/or shape-based poses (extensible to use other modalities as source of information)
|
|
1 | 2017-01-26 | omip_launch |
This package only contains launch files for the complete OMIP system.
This package only contains launch files for the complete OMIP system.
|
|
1 | 2017-01-26 | omip_common |
Library with the common utilities to be used for the packages of OMIP
Library with the common utilities to be used for the packages of OMIP
|
|
1 | 2017-01-26 | omip |
This metapackage groups all the packages for Online Multimodal Interactive Perception (OMIP).
This metapackage groups all the packages for Online Multimodal Interactive Perception (OMIP).
|
|
1 | 2017-01-26 | lgsm |
ROS package for the Lie Group for Solid Mechanics by CEA LIST (DIASI/LSI) xde-support@saxifrage.cea.fr
ROS package for the Lie Group for Solid Mechanics by CEA LIST (DIASI/LSI) xde-support@saxifrage.cea.fr
|
|
1 | 2017-01-26 | joint_tracker |
Tracker of the kinematic model (structure and state) based on the motion of a set of rigid bodies
Tracker of the kinematic model (structure and state) based on the motion of a set of rigid bodies
|
|
1 | 2017-01-26 | feature_tracker |
Tracker of 3-D features (up to now, only LK point features, extensible to other type of basic features) on an RGB-D stream
Tracker of 3-D features (up to now, only LK point features, extensible to other type of basic features) on an RGB-D stream
|
|
1 | 2017-01-25 | feed_the_troll |
Mechanisms for loading a ros node at runtime.
Mechanisms for loading a ros node at runtime.
|
|
1 | 2017-01-25 | costmap_prohibition_layer |
ROS-Package that implements a costmap layer to add prohibited areas to the costmap-2D by a user configuration.
ROS-Package that implements a costmap layer to add prohibited areas to the costmap-2D by a user configuration.
|
|
1 | 2017-01-24 | omip_msgs |
Messages for OMIP - Online Multimodal Interactive Perception
Messages for OMIP - Online Multimodal Interactive Perception
|
|
1 | 2017-01-23 | zeroconf_avahi_suite |
Suite of packages supporing the avahi implementation of zeroconf for ros.
Suite of packages supporing the avahi implementation of zeroconf for ros.
|
|
1 | 2017-01-23 | zeroconf_avahi_demos |
Several demos and launch-tests for the avahi based zero-configuration.
Several demos and launch-tests for the avahi based zero-configuration.
|
|
1 | 2017-01-23 | zeroconf_avahi |
Provides zeroconf services on avahi for ros systems.
This is a c++ implementation.
Provides zeroconf services on avahi for ros systems.
This is a c++ implementation.
|
|
1 | 2017-01-20 | nao_moveit_config |
An automatically generated package with all the configuration and launch files for using the NAO robot with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the NAO robot with the MoveIt Motion Planning Framework
|
|
1 | 2017-01-18 | pepper_moveit_config |
An automatically generated package with all the configuration and launch files for using the Pepper robot with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the Pepper robot with the MoveIt Motion Planning Framework
|
|
1 | 2017-01-13 | youbot_description |
Robot descriptions in form of URDF files and meshes
Robot descriptions in form of URDF files and meshes
|
|
1 | 2017-01-12 | yujin_ocs |
Yujin Robot's open-source control software
Yujin Robot's open-source control software
|
|
1 | 2017-01-12 | yocs_waypoints_navi |
Simple tool for waypoints navigation with two functions:
Simple tool for waypoints navigation with two functions:
|
|
1 | 2017-01-12 | yocs_waypoint_provider |
Parse a multiple poses from yaml and provide as topic and service. This package is highly inspired by yocs_waypoints_navi
Parse a multiple poses from yaml and provide as topic and service. This package is highly inspired by yocs_waypoints_navi
|
|
1 | 2017-01-12 | yocs_virtual_sensor |
Virtual sensor that uses semantic map information to "see" obstacles undetectable by robot sensors.
Current implementation cannot read obstacles from YAML files. Until this feature gets implemented, we
use auxiliary scripts to read and publish files' content. Data directory contains some example files.
Virtual sensor that uses semantic map information to "see" obstacles undetectable by robot sensors.
Current implementation cannot read obstacles from YAML files. Until this feature gets implemented, we
use auxiliary scripts to read and publish files' content. Data directory contains some example files.
|
|
1 | 2017-01-12 | yocs_velocity_smoother |
Bound incoming velocity messages according to robot velocity and acceleration limits.
Bound incoming velocity messages according to robot velocity and acceleration limits.
|
|
1 | 2017-01-12 | yocs_safety_controller |
A controller ensuring the safe operation of your robot.
The SafetyController listens to ranger readings in order to stop (and move back), if obstacles get to close.
This controller can be enabled/disabled.
A controller ensuring the safe operation of your robot.
The SafetyController listens to ranger readings in order to stop (and move back), if obstacles get to close.
This controller can be enabled/disabled.
|
|
1 | 2017-01-12 | yocs_rapps |
Yujin open control system rapps for use with the app manager and rocon concert
Yujin open control system rapps for use with the app manager and rocon concert
|
|
1 | 2017-01-12 | yocs_navigator |
Navigation module for robots
Navigation module for robots
|
|
1 | 2017-01-12 | yocs_navi_toolkit |
Ros navigation utilities.
Ros navigation utilities.
|
|
1 | 2017-01-12 | yocs_math_toolkit |
Math toolkit for Yujin open control system. This package is intended to contain common use functions,
mostly for simple mathematics but also for tf-related conversions.
By no means it pretends to be an efficient and robust, widely used math library, but a play ground where
to put common code that is typically repeated in many robot control programs.
Math toolkit for Yujin open control system. This package is intended to contain common use functions,
mostly for simple mathematics but also for tf-related conversions.
By no means it pretends to be an efficient and robust, widely used math library, but a play ground where
to put common code that is typically repeated in many robot control programs.
|
|
1 | 2017-01-12 | yocs_localization_manager |
Localization Manager helps to localize robot's position with annotated information
Localization Manager helps to localize robot's position with annotated information
|
|
1 | 2017-01-12 | yocs_keyop |
Keyboard teleoperation for your robot
Keyboard teleoperation for your robot
|
|
1 | 2017-01-12 | yocs_joyop |
Joystick teleoperation for your robot robot core
Joystick teleoperation for your robot robot core
|
|
1 | 2017-01-12 | yocs_diff_drive_pose_controller |
A controller for driving a differential drive base to a pose goal or along a path specified by multiple poses.
A pose consists of a 2D position (x,y) and a 1D orientation (theta).
A controller for driving a differential drive base to a pose goal or along a path specified by multiple poses.
A pose consists of a 2D position (x,y) and a 1D orientation (theta).
|
|
1 | 2017-01-12 | yocs_controllers |
Library for various controller types and algorithms
Library for various controller types and algorithms
|
|
1 | 2017-01-12 | yocs_cmd_vel_mux |
A multiplexer for command velocity inputs. Arbitrates incoming cmd_vel messages from several topics,
allowing one topic at a time to command the robot, based on priorities. It also deallocates current
allowed topic if no messages are received after a configured timeout. All topics, together with their
priority and timeout are configured through a YAML file, that can be reload at runtime.
A multiplexer for command velocity inputs. Arbitrates incoming cmd_vel messages from several topics,
allowing one topic at a time to command the robot, based on priorities. It also deallocates current
allowed topic if no messages are received after a configured timeout. All topics, together with their
priority and timeout are configured through a YAML file, that can be reload at runtime.
|
|
1 | 2017-01-12 | yocs_ar_pair_tracking |
The AR pair tracking package
The AR pair tracking package
|
|
1 | 2017-01-12 | yocs_ar_pair_approach |
Search and approach behaviour, moving to a target in front of a pair of ar markers.
Search and approach behaviour, moving to a target in front of a pair of ar markers.
|
|
1 | 2017-01-12 | yocs_ar_marker_tracking |
Collecting, tracking and generating statistics for ar markers from ar_track_alvar.
Collecting, tracking and generating statistics for ar markers from ar_track_alvar.
|
|
1 | 2017-01-12 | feed_the_troll_msgs |
Messages used to feed the trolls.
Messages used to feed the trolls.
|
|
1 | 2017-01-05 | genrs |
Rust ROS message and service generators
Rust ROS message and service generators
|
|
2 | 2017-01-04 | moveit_sim_controller |
A simulation interface for a hardware interface for ros_control, and loads default joint values from SRDF
A simulation interface for a hardware interface for ros_control, and loads default joint values from SRDF
|
|
1 | 2016-12-29 | ethercat_grant |
Makes it possible to run the ros_ethercat_loop without using sudo. Forked from pr2-grant
Makes it possible to run the ros_ethercat_loop without using sudo. Forked from pr2-grant
|
|
1 | 2016-12-26 | rosjava |
This is a meta package for the official rosjava repositories.
This is a meta package for the official rosjava repositories.
|
|
1 | 2016-12-24 | rosjava_messages |
Message generation for rosjava.
Message generation for rosjava.
|
|
1 | 2016-12-19 | ros_wild |
The ros_wild package
The ros_wild package
|
|
1 | 2016-12-14 | rosjava_test_msgs |
Test messages for rosjava.
Test messages for rosjava.
|
|
1 | 2016-12-07 | ardrone_autonomy |
ardrone_autonomy is a ROS driver for Parrot AR-Drone 1.0 and 2.0 quadrocopters. This driver is based on official AR-Drone SDK version 2.0.1.
ardrone_autonomy is a ROS driver for Parrot AR-Drone 1.0 and 2.0 quadrocopters. This driver is based on official AR-Drone SDK version 2.0.1.
|
|
1 | 2016-11-28 | jaguar_navigation |
Navigation package for DrRobot's Jaguar 4X4
Navigation package for DrRobot's Jaguar 4X4
|
|
1 | 2016-11-28 | jaguar_msgs |
Messages for DrRobot's Jaguar 4X4
Messages for DrRobot's Jaguar 4X4
|
|
1 | 2016-11-28 | jaguar_description |
A robot description package for Dr Robot's Jaguar 4x4
A robot description package for Dr Robot's Jaguar 4x4
|
|
1 | 2016-11-28 | jaguar_control |
DrRobot's Jaguar 4X4 controller configurations
DrRobot's Jaguar 4X4 controller configurations
|
|
1 | 2016-11-24 | fzi_icl_comm |
The fzi_icl_comm package
The fzi_icl_comm package
|
|
1 | 2016-11-16 | moveit_msgs |
Messages, services and actions used by MoveIt
Messages, services and actions used by MoveIt
|
|
1 | 2016-11-13 | tuw_uvc |
The tuw_uvc package is a USB-Camera driver with a dynamic reconfigure interface optimized for logitech cameras.
The tuw_uvc package is a USB-Camera driver with a dynamic reconfigure interface optimized for logitech cameras.
|
|
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 | 2016-11-09 | tuw_marker_slam |
The tuw_marker_slam package provides a framework for feature based SLAM implementations in ROS.
Meanwhile a variant of EKF-SLAM is implemented.
The tuw_marker_slam package provides a framework for feature based SLAM implementations in ROS.
Meanwhile a variant of EKF-SLAM is implemented.
|
|
1 | 2016-11-09 | tuw_marker_server |
The tuw_marker_server package contains a map server for saving and providing marker maps based on MarkerWithCovarianceArray messages from the marker_msgs package.
The tuw_marker_server package contains a map server for saving and providing marker maps based on MarkerWithCovarianceArray messages from the marker_msgs package.
|
|
1 | 2016-11-09 | tuw_marker_noise |
The tuw_marker_noise package provides nodes
for adding artificial noise to MarkerDetection messages from the marker_msgs package and
for recording MarkerDetection messages in order to obtain a measurement noise model.
The tuw_marker_noise package provides nodes
for adding artificial noise to MarkerDetection messages from the marker_msgs package and
for recording MarkerDetection messages in order to obtain a measurement noise model.
|
|
1 | 2016-11-09 | tuw_marker_filter |
The tuw_marker_filter package
The tuw_marker_filter package
|
|
1 | 2016-11-09 | ecl_navigation |
This stack aims to bring the common tools and algorithms needed to
develop navigation algorithms, in particular slam. It does not focus on
the end-point solution, rather the tools needed to create a variety of
end-point solutions.
This stack aims to bring the common tools and algorithms needed to
develop navigation algorithms, in particular slam. It does not focus on
the end-point solution, rather the tools needed to create a variety of
end-point solutions.
|
|
2 | 2016-11-09 | ecl_mobile_robot |
Contains transforms (e.g. differential drive inverse kinematics)
for the various types of mobile robot platforms.
Contains transforms (e.g. differential drive inverse kinematics)
for the various types of mobile robot platforms.
|
|
1 | 2016-11-07 | marker_rviz_plugin |
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
|
|
1 | 2016-10-27 | pcl_msgs |
Package containing PCL (Point Cloud Library)-related ROS messages.
Package containing PCL (Point Cloud Library)-related ROS messages.
|
|
3 | 2016-10-27 | pcl_conversions |
Provides conversions from PCL data types and ROS message types
Provides conversions from PCL data types and ROS message types
|
|
1 | 2016-10-23 | mm_radio |
Multiplexing many packet types across a two-way radio connection with publishers and subscribers.
Great for embedded connections by two-way serial or ethernet types.
Multiplexing many packet types across a two-way radio connection with publishers and subscribers.
Great for embedded connections by two-way serial or ethernet types.
|
|
1 | 2016-10-23 | mm_mux_demux |
Multiplexing many packet types across a single connection. Great for embedded connections
by serial or ethernet types.
Multiplexing many packet types across a single connection. Great for embedded connections
by serial or ethernet types.
|
|
1 | 2016-10-23 | mm_messages |
Message definitions and serialisations for core messages.
Message definitions and serialisations for core messages.
|
|
1 | 2016-10-23 | mm_eigen_msgs |
Message definitions and serialisations for Eigen messages.
Message definitions and serialisations for Eigen messages.
|