Packages
Name | Description | |||
---|---|---|---|---|
1 | 2024-11-25 | examples_rclpy_minimal_service |
Examples of minimal service servers using rclpy.
Examples of minimal service servers using rclpy.
|
|
1 | 2024-11-25 | examples_rclpy_minimal_publisher |
Examples of minimal publishers using rclpy.
Examples of minimal publishers using rclpy.
|
|
1 | 2024-11-25 | examples_rclpy_minimal_client |
Examples of minimal service clients using rclpy.
Examples of minimal service clients using rclpy.
|
|
1 | 2024-11-25 | examples_rclpy_minimal_action_server |
Examples of minimal action servers using rclpy.
Examples of minimal action servers using rclpy.
|
|
1 | 2024-11-25 | examples_rclpy_minimal_action_client |
Examples of minimal action clients using rclpy.
Examples of minimal action clients using rclpy.
|
|
1 | 2024-11-25 | examples_rclpy_guard_conditions |
Examples of using guard conditions.
Examples of using guard conditions.
|
|
1 | 2024-11-25 | examples_rclpy_executors |
Examples of creating and using exectors to run multiple nodes in the same process
Examples of creating and using exectors to run multiple nodes in the same process
|
|
1 | 2024-11-25 | examples_rclcpp_wait_set |
Example of how to use the rclcpp::WaitSet directly.
Example of how to use the rclcpp::WaitSet directly.
|
|
1 | 2024-11-25 | examples_rclcpp_multithreaded_executor |
Package containing example of how to implement a multithreaded executor
Package containing example of how to implement a multithreaded executor
|
|
1 | 2024-11-25 | examples_rclcpp_minimal_timer |
Examples of minimal nodes which have timers
Examples of minimal nodes which have timers
|
|
1 | 2024-11-25 | examples_rclcpp_minimal_subscriber |
Examples of minimal subscribers
Examples of minimal subscribers
|
|
1 | 2024-11-25 | examples_rclcpp_minimal_service |
A minimal service server which adds two numbers
A minimal service server which adds two numbers
|
|
1 | 2024-11-25 | examples_rclcpp_minimal_publisher |
Examples of minimal publisher nodes
Examples of minimal publisher nodes
|
|
1 | 2024-11-25 | examples_rclcpp_minimal_composition |
Minimalist examples of composing nodes in the same
process
Minimalist examples of composing nodes in the same
process
|
|
1 | 2024-11-25 | examples_rclcpp_minimal_client |
Examples of minimal service clients
Examples of minimal service clients
|
|
1 | 2024-11-25 | examples_rclcpp_minimal_action_server |
Minimal action server examples
Minimal action server examples
|
|
1 | 2024-11-25 | examples_rclcpp_minimal_action_client |
Minimal action client examples
Minimal action client examples
|
|
1 | 2024-11-25 | examples_rclcpp_cbg_executor |
Example for multiple Executor instances in one process, using the callback-group-level interface of the Executor class.
Example for multiple Executor instances in one process, using the callback-group-level interface of the Executor class.
|
|
1 | 2024-11-25 | examples_rclcpp_async_client |
Example of an async service client
Example of an async service client
|
|
2 | 2024-11-25 | cob_srvs |
This Package contains Care-O-bot specific service definitions.
This Package contains Care-O-bot specific service definitions.
|
|
2 | 2024-11-25 | cob_msgs |
Messages for representing state information, such as battery information and emergency stop status.
Messages for representing state information, such as battery information and emergency stop status.
|
|
2 | 2024-11-25 | cob_common |
The cob_common stack hosts common packages that are used within the Care-O-bot repository. E.g. utility packages or common message and service definitions etc. Also the urdf desciption of the robot is located in this stack.
The cob_common stack hosts common packages that are used within the Care-O-bot repository. E.g. utility packages or common message and service definitions etc. Also the urdf desciption of the robot is located in this stack.
|
|
2 | 2024-11-25 | cob_actions |
This Package contains Care-O-bot specific action definitions.
This Package contains Care-O-bot specific action definitions.
|
|
1 | 2024-11-25 | caret_trace |
Library to add tracepoints for CARET
Library to add tracepoints for CARET
|
|
1 | 2024-11-25 | caret_msgs |
Message definitions for CARET
Message definitions for CARET
|
|
1 | 2024-11-25 | caret_analyze_cpp_impl |
c++ implementation of caret_analyze
c++ implementation of caret_analyze
|
|
1 | 2024-11-25 | caret_analyze |
CARET's tools for analyzing trace results
CARET's tools for analyzing trace results
|
|
1 | 2024-11-25 | ament_cmake_version |
The ability to override the exported package version in the ament buildsystem.
The ability to override the exported package version in the ament buildsystem.
|
|
1 | 2024-11-25 | ament_cmake_vendor_package |
Macros for maintaining a 'vendor' package.
Macros for maintaining a 'vendor' package.
|
|
1 | 2024-11-25 | ament_cmake_test |
The ability to add tests in the ament buildsystem in CMake.
The ability to add tests in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_target_dependencies |
The ability to add definitions, include directories and libraries of a package to a target in the ament buildsystem in CMake.
The ability to add definitions, include directories and libraries of a package to a target in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_python |
The ability to use Python in the ament buildsystem in CMake.
The ability to use Python in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_pytest |
The ability to run Python tests using pytest in the ament buildsystem in CMake.
The ability to run Python tests using pytest in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_nose |
The ability to add nose-based tests in the ament buildsystem in CMake.
The ability to add nose-based tests in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_libraries |
The functionality to deduplicate libraries in the ament buildsystem in CMake.
The functionality to deduplicate libraries in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_include_directories |
The functionality to order include directories according to a chain of prefixes in the ament buildsystem in CMake.
The functionality to order include directories according to a chain of prefixes in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_gtest |
The ability to add gtest-based tests in the ament buildsystem in CMake.
The ability to add gtest-based tests in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_google_benchmark |
The ability to add Google Benchmark tests in the ament buildsystem in CMake.
The ability to add Google Benchmark tests in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_gmock |
The ability to add Google mock-based tests in the ament buildsystem in CMake.
The ability to add Google mock-based tests in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_gen_version_h |
Generate a C header containing the version number of the package
Generate a C header containing the version number of the package
|
|
1 | 2024-11-25 | ament_cmake_export_targets |
The ability to export targets to downstream packages in the ament buildsystem in CMake.
The ability to export targets to downstream packages in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_export_link_flags |
The ability to export link flags to downstream packages in the ament buildsystem.
The ability to export link flags to downstream packages in the ament buildsystem.
|
|
1 | 2024-11-25 | ament_cmake_export_libraries |
The ability to export libraries to downstream packages in the ament buildsystem in CMake.
The ability to export libraries to downstream packages in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_export_interfaces |
The ability to export interfaces to downstream packages in the ament buildsystem in CMake.
The ability to export interfaces to downstream packages in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_export_include_directories |
The ability to export include directories to downstream packages in the ament buildsystem in CMake.
The ability to export include directories to downstream packages in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_export_dependencies |
The ability to export dependencies to downstream packages in the ament buildsystem in CMake.
The ability to export dependencies to downstream packages in the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake_export_definitions |
The ability to export definitions to downstream packages in the ament buildsystem.
The ability to export definitions to downstream packages in the ament buildsystem.
|
|
1 | 2024-11-25 | ament_cmake_core |
The core of the ament buildsystem in CMake.
Several subcomponents provide specific funtionalities:
* environment: provide prefix-level setup files
* environment_hooks: provide package-level setup files and environment hooks
* index: store information in an index and retrieve them without crawling
* package_templates: templates from the ament_package Python package
* symlink_install: use symlinks for CMake install commands
The core of the ament buildsystem in CMake.
Several subcomponents provide specific funtionalities:
* environment: provide prefix-level setup files
* environment_hooks: provide package-level setup files and environment hooks
* index: store information in an index and retrieve them without crawling
* package_templates: templates from the ament_package Python package
* symlink_install: use symlinks for CMake install commands
|
|
1 | 2024-11-25 | ament_cmake_auto |
The auto-magic functions for ease to use of the ament buildsystem in CMake.
The auto-magic functions for ease to use of the ament buildsystem in CMake.
|
|
1 | 2024-11-25 | ament_cmake |
The entry point package for the ament buildsystem in CMake.
The entry point package for the ament buildsystem in CMake.
|
|
1 | 2024-11-24 | plotjuggler |
PlotJuggler: juggle with data
PlotJuggler: juggle with data
|
|
1 | 2024-11-24 | hatchbed_common |
Common Hatchbed C++ utility code for ROS, such registering and handling updates to ros parameters.
Common Hatchbed C++ utility code for ROS, such registering and handling updates to ros parameters.
|
|
1 | 2024-11-24 | clips_vendor |
Vendor package for the CLIPS rule based production system
Vendor package for the CLIPS rule based production system
|
|
1 | 2024-11-23 | magic_enum |
Static reflection for enums (to string, from string, iteration) for modern C++,
work with any enum type without any macro or boilerplate code
Static reflection for enums (to string, from string, iteration) for modern C++,
work with any enum type without any macro or boilerplate code
|
|
1 | 2024-11-23 | dual_laser_merger |
merge dual lidar's scans.
merge dual lidar's scans.
|
|
1 | 2024-11-22 | rosbag2_to_video |
Command line tool to create a video from a rosbag recording
Command line tool to create a video from a rosbag recording
|
|
1 | 2024-11-22 | psdk_wrapper |
ROS2 wrapper for the DJI PSDK
ROS2 wrapper for the DJI PSDK
|
|
1 | 2024-11-22 | psdk_interfaces |
Provides custom message, srv and action types for psdk ros2 wrapper
Provides custom message, srv and action types for psdk ros2 wrapper
|
|
1 | 2024-11-22 | omni_base_robot |
The omni_base_robot package
The omni_base_robot package
|
|
1 | 2024-11-22 | omni_base_description |
This package contains the description (mechanical, kinematic, visual,
etc.) of the omni_base robot. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
This package contains the description (mechanical, kinematic, visual,
etc.) of the omni_base robot. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
|
|
1 | 2024-11-22 | omni_base_controller_configuration |
The omni_base_controller_configuration package
The omni_base_controller_configuration package
|
|
1 | 2024-11-22 | omni_base_bringup |
The omni_base_bringup package
The omni_base_bringup package
|
|
1 | 2024-11-22 | microstrain_inertial_rqt |
The microstrain_inertial_rqt package provides several RQT widgets to view the status of Microstrain devices
The microstrain_inertial_rqt package provides several RQT widgets to view the status of Microstrain devices
|
|
1 | 2024-11-22 | microstrain_inertial_msgs |
A package that contains ROS message corresponding to microstrain message types.
A package that contains ROS message corresponding to microstrain message types.
|
|
1 | 2024-11-22 | microstrain_inertial_examples |
Simple examples using the microstrain_inertial_driver for MicroStrain sensors.
Simple examples using the microstrain_inertial_driver for MicroStrain sensors.
|
|
1 | 2024-11-22 | microstrain_inertial_driver |
The ros_mscl package provides a driver for the LORD/Microstrain inertial products.
The ros_mscl package provides a driver for the LORD/Microstrain inertial products.
|
|
1 | 2024-11-22 | microstrain_inertial_description |
URDF and stl files for MicroStrain sensors.
URDF and stl files for MicroStrain sensors.
|
|
1 | 2024-11-21 | spinnaker_synchronized_camera_driver |
ROS2 driver for synchronized flir cameras using the Spinnaker SDK
ROS2 driver for synchronized flir cameras using the Spinnaker SDK
|
|
1 | 2024-11-21 | spinnaker_camera_driver |
ROS2 driver for flir spinnaker sdk
ROS2 driver for flir spinnaker sdk
|
|
1 | 2024-11-21 | simple_launch |
Python helper class for the ROS 2 launch system
Python helper class for the ROS 2 launch system
|
|
2 | 2024-11-21 | reach_ros |
The reach_ros package
The reach_ros package
|
|
1 | 2024-11-21 | flir_camera_msgs |
messages related to flir camera driver
messages related to flir camera driver
|
|
1 | 2024-11-21 | flir_camera_description |
FLIR camera Description package
FLIR camera Description package
|
|
1 | 2024-11-21 | andino_slam |
The andino_slam package
The andino_slam package
|
|
1 | 2024-11-21 | andino_navigation |
Bring up nav2 package with Andino.
Bring up nav2 package with Andino.
|
|
1 | 2024-11-21 | andino_hardware |
The andino_hardware package
The andino_hardware package
|
|
1 | 2024-11-21 | andino_gz_classic |
Launch Gazebo simulation with Andino
Launch Gazebo simulation with Andino
|
|
1 | 2024-11-21 | andino_firmware |
The andino_firmware package
The andino_firmware package
|
|
1 | 2024-11-21 | andino_description |
The andino_description package
The andino_description package
|
|
1 | 2024-11-21 | andino_control |
The andino_control package
The andino_control package
|
|
1 | 2024-11-21 | andino_bringup |
Contains launch files to bring up andinobot robot.
Contains launch files to bring up andinobot robot.
|
|
1 | 2024-11-21 | andino_base |
The andino_base package
The andino_base package
|
|
1 | 2024-11-21 | andino_apps |
Package for apps created with andino
Package for apps created with andino
|
|
1 | 2024-11-20 | tf_to_pose_publisher |
Publish a tf transform to a pose topic
Publish a tf transform to a pose topic
|
|
1 | 2024-11-20 | tb4_sim_scenario |
TurtleBot 4 Simulation Scenario Execution
TurtleBot 4 Simulation Scenario Execution
|
|
1 | 2024-11-20 | scenario_status |
Simple node to call a service to publish the py-trees-\
behaviour tree to a topic, then subscribe to that topic and publish \
changes in behaviour states as strings at the time they are \
happening
Simple node to call a service to publish the py-trees-\
behaviour tree to a topic, then subscribe to that topic and publish \
changes in behaviour states as strings at the time they are \
happening
|
|
1 | 2024-11-20 | scenario_execution_x11 |
Scenario Execution library for X11
Scenario Execution library for X11
|
|
1 | 2024-11-20 | scenario_execution_test |
Tests for Scenario Execution library
Tests for Scenario Execution library
|
|
1 | 2024-11-20 | scenario_execution_rviz |
The scenario_execution_rviz package
The scenario_execution_rviz package
|
|
1 | 2024-11-20 | scenario_execution_ros_test |
Tests for Scenario Execution library for ROS
Tests for Scenario Execution library for ROS
|
|
1 | 2024-11-20 | scenario_execution_ros |
Scenario Execution for ROS
Scenario Execution for ROS
|
|
1 | 2024-11-20 | scenario_execution_pybullet |
Scenario Execution library for PyBullet
Scenario Execution library for PyBullet
|
|
1 | 2024-11-20 | scenario_execution_py_trees_ros |
Fixes in py-trees-ros not yet release
Fixes in py-trees-ros not yet release
|
|
1 | 2024-11-20 | scenario_execution_os |
Scenario Execution library for OS interactions
Scenario Execution library for OS interactions
|
|
1 | 2024-11-20 | scenario_execution_nav2_test |
Tests for Scenario Execution library for Nav2
Tests for Scenario Execution library for Nav2
|
|
1 | 2024-11-20 | scenario_execution_nav2 |
Scenario Execution library for Nav2
Scenario Execution library for Nav2
|
|
1 | 2024-11-20 | scenario_execution_moveit2 |
Scenario Execution library for moveIt2
Scenario Execution library for moveIt2
|
|
1 | 2024-11-20 | scenario_execution_kubernetes |
Package for scenario execution kubernetes library
Package for scenario execution kubernetes library
|
|
1 | 2024-11-20 | scenario_execution_interfaces |
ROS2 Interfaces for Scenario Execution
ROS2 Interfaces for Scenario Execution
|
|
1 | 2024-11-20 | scenario_execution_gazebo_test |
Tests for Scenario Execution library for Gazebo
Tests for Scenario Execution library for Gazebo
|
|
1 | 2024-11-20 | scenario_execution_gazebo |
Scenario Execution library for Gazebo
Scenario Execution library for Gazebo
|
|
1 | 2024-11-20 | scenario_execution_floorplan_dsl |
Scenario Execution library for Floorplan DSL
Scenario Execution library for Floorplan DSL
|
|
1 | 2024-11-20 | scenario_execution_docker_test |
Tests for Scenario Execution library for Docker
Tests for Scenario Execution library for Docker
|
|
1 | 2024-11-20 | scenario_execution_docker |
Scenario Execution library for docker interactions
Scenario Execution library for docker interactions
|
|
1 | 2024-11-20 | scenario_execution_coverage |
Robotics Scenario Execution Coverage Tools
Robotics Scenario Execution Coverage Tools
|
|
1 | 2024-11-20 | scenario_execution_control |
Scenario Execution Control
Scenario Execution Control
|
|
1 | 2024-11-20 | scenario_execution |
Scenario Execution
Scenario Execution
|
|
1 | 2024-11-20 | message_modification |
Modification of message data
Modification of message data
|
|
1 | 2024-11-20 | gazebo_tf_publisher |
Node to publish ignition ground truth TF tree
Node to publish ignition ground truth TF tree
|
|
1 | 2024-11-20 | gazebo_static_camera |
Spawn a static camera within a gazebo world
Spawn a static camera within a gazebo world
|
|
1 | 2024-11-20 | example_simulation |
Scenario Execution Example for Simulation
Scenario Execution Example for Simulation
|
|
1 | 2024-11-20 | example_scenario_control |
Scenario Execution Example for Scenario Control using RVIZ
Scenario Execution Example for Scenario Control using RVIZ
|
|
1 | 2024-11-20 | example_multi_robot |
Example Multi Robot
Example Multi Robot
|
|
1 | 2024-11-20 | arm_sim_scenario |
MoveIt2 Arm Simulation Scenario Execution
MoveIt2 Arm Simulation Scenario Execution
|
|
1 | 2024-11-19 | urdf_test |
The urdf_test package
The urdf_test package
|
|
1 | 2024-11-19 | rmf_workcell_msgs |
A package containing messages used by all workcells generically to interfact with rmf_core
A package containing messages used by all workcells generically to interfact with rmf_core
|
|
1 | 2024-11-19 | rmf_traffic_msgs |
A package containing messages used by the RMF traffic management system.
A package containing messages used by the RMF traffic management system.
|
|
1 | 2024-11-19 | rmf_task_msgs |
A package containing messages used to specify tasks
A package containing messages used to specify tasks
|
|
1 | 2024-11-19 | rmf_site_map_msgs |
Messages that contain GeoPackage maps
Messages that contain GeoPackage maps
|
|
1 | 2024-11-19 | rmf_scheduler_msgs |
Messages used by rmf_scheduler_msgs
Messages used by rmf_scheduler_msgs
|
|
1 | 2024-11-19 | rmf_obstacle_msgs |
A package containing messages for describing obstacles in the environment
A package containing messages for describing obstacles in the environment
|
|
1 | 2024-11-19 | rmf_lift_msgs |
Messages used to interface to lifts.
Messages used to interface to lifts.
|
|
1 | 2024-11-19 | rmf_ingestor_msgs |
A package containing messages used to interface to ingestor workcells
A package containing messages used to interface to ingestor workcells
|
|
1 | 2024-11-19 | rmf_fleet_msgs |
A package containing messages used to interface to fleet managers
A package containing messages used to interface to fleet managers
|
|
1 | 2024-11-19 | rmf_door_msgs |
Messages used to interface to doors
Messages used to interface to doors
|
|
1 | 2024-11-19 | rmf_dispenser_msgs |
A package containing messages used to interface to dispenser workcells
A package containing messages used to interface to dispenser workcells
|
|
1 | 2024-11-19 | rmf_charger_msgs |
This package contains messages regarding charging and discharging
This package contains messages regarding charging and discharging
|
|
1 | 2024-11-19 | qml_ros2_plugin |
A QML plugin for ROS.
Enables full communication with ROS from QML.
A QML plugin for ROS.
Enables full communication with ROS from QML.
|
|
1 | 2024-11-19 | odom_to_tf_ros2 |
A simple ros2 package (node) that reads an odom topic and generates the equivalent tf connection (transformation). It also provides options to override frame names, or just use the ones in the original odom topic.
A simple ros2 package (node) that reads an odom topic and generates the equivalent tf connection (transformation). It also provides options to override frame names, or just use the ones in the original odom topic.
|
|
1 | 2024-11-19 | interactive_marker_twist_server |
Interactive control for generic Twist-based robots using interactive markers
Interactive control for generic Twist-based robots using interactive markers
|
|
1 | 2024-11-19 | hri_privacy_msgs |
ROS message definitions for declaring privacy-sensitive data flows
ROS message definitions for declaring privacy-sensitive data flows
|
|
1 | 2024-11-19 | hri_face_body_matcher |
The hri_face_body_matcher package
The hri_face_body_matcher package
|
|
1 | 2024-11-19 | fields2cover |
Robust and efficient coverage paths for autonomous agricultural vehicles.
A modular and extensible Coverage Path Planning library
Robust and efficient coverage paths for autonomous agricultural vehicles.
A modular and extensible Coverage Path Planning library
|
|
1 | 2024-11-18 | play_motion2_msgs |
Play a pre-recorded motion on a robot
Play a pre-recorded motion on a robot
|
|
1 | 2024-11-18 | play_motion2 |
Play a pre-recorded motion on a robot
Play a pre-recorded motion on a robot
|
|
2 | 2024-11-18 | leo_robot |
Metapackage of software to install on Leo Rover.
Metapackage of software to install on Leo Rover.
|
|
2 | 2024-11-18 | leo_fw |
Binary releases of Leo Rover firmware and related utilities
Binary releases of Leo Rover firmware and related utilities
|
|
2 | 2024-11-18 | leo_bringup |
Scripts and launch files for starting basic Leo Rover functionalities.
Scripts and launch files for starting basic Leo Rover functionalities.
|
|
1 | 2024-11-18 | foxglove_compressed_video_transport |
foxglove_compressed_video_transport provides a plugin to image_transport for
transparently sending an image stream encoded in foxglove compressed video packets.
foxglove_compressed_video_transport provides a plugin to image_transport for
transparently sending an image stream encoded in foxglove compressed video packets.
|
|
1 | 2024-11-16 | twist_stamper |
ROS2 package for converting between Twist and TwistStamped messages
ROS2 package for converting between Twist and TwistStamped messages
|
|
1 | 2024-11-16 | joy_tester |
Simple GUI tool for testing joysticks/gamepads
Simple GUI tool for testing joysticks/gamepads
|
|
1 | 2024-11-14 | kompass_interfaces |
ROS2 Interfaces for Kompass
ROS2 Interfaces for Kompass
|
|
1 | 2024-11-14 | kompass |
Kompass: Event-driven navigation system
Kompass: Event-driven navigation system
|
|
1 | 2024-11-14 | hebi_cpp_api |
A ROS 2 package providing access to the HEBI C++ API.
A ROS 2 package providing access to the HEBI C++ API.
|
|
2 | 2024-11-14 | adi_tmcl |
The adi_tmcl ROS2 package
The adi_tmcl ROS2 package
|
|
1 | 2024-11-13 | xacro |
Xacro (XML Macros)
Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
Xacro (XML Macros)
Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
|
|
1 | 2024-11-13 | libfranka |
libfranka is a C++ library for Franka Robotics research robots
libfranka is a C++ library for Franka Robotics research robots
|
|
1 | 2024-11-13 | jacro |
TODO: Project Short Description
TODO: Project Short Description
|
|
1 | 2024-11-13 | feetech_ros2_driver |
ros2_control hardware interface for Feetech Servos
ros2_control hardware interface for Feetech Servos
|
|
1 | 2024-11-12 | cyclonedds |
Eclipse Cyclone DDS is a very performant and robust open-source DDS implementation. Cyclone DDS is developed completely in the open as an Eclipse IoT project.
Eclipse Cyclone DDS is a very performant and robust open-source DDS implementation. Cyclone DDS is developed completely in the open as an Eclipse IoT project.
|
|
1 | 2024-11-12 | bcr_bot |
bcr_bot
bcr_bot
|
|
1 | 2024-11-11 | urdfdom_py |
Python implementation of the URDF parser.
Python implementation of the URDF parser.
|
|
1 | 2024-11-11 | slg_msgs |
This package provides classes and messages to interact with laser related geometry.
This package provides classes and messages to interact with laser related geometry.
|
|
1 | 2024-11-11 | laser_segmentation |
Implementation of algorithms for segmentation of laserscans.
Implementation of algorithms for segmentation of laserscans.
|
|
1 | 2024-11-10 | data_tamer_msgs |
Interfaces for data_tamer
Interfaces for data_tamer
|
|
1 | 2024-11-10 | data_tamer_cpp |
DataTamer data logging library
DataTamer data logging library
|
|
1 | 2024-11-08 | simple_grasping |
Basic grasping applications and demos.
Basic grasping applications and demos.
|
|
1 | 2024-11-08 | rmf_traffic_editor_test_maps |
Some test maps for traffic_editor and rmf_building_map_tools.
Some test maps for traffic_editor and rmf_building_map_tools.
|
|
1 | 2024-11-08 | rmf_traffic_editor_assets |
Assets for use with traffic_editor.
Assets for use with traffic_editor.
|
|
1 | 2024-11-08 | rmf_traffic_editor |
traffic editor
traffic editor
|
|
1 | 2024-11-08 | rmf_building_map_tools |
RMF Building map tools
RMF Building map tools
|
|
2 | 2024-11-08 | octomap_msgs |
This package provides messages and serializations / conversion for the
This package provides messages and serializations / conversion for the
|
|
2 | 2024-11-08 | leo_teleop |
Scripts and launch files for Leo Rover teleoperation
Scripts and launch files for Leo Rover teleoperation
|
|
2 | 2024-11-08 | leo_simulator |
Metapackage for Leo Rover Gazebo simulation in ROS2
Metapackage for Leo Rover Gazebo simulation in ROS2
|
|
2 | 2024-11-08 | leo_msgs |
Message and Service definitions for Leo Rover
Message and Service definitions for Leo Rover
|
|
1 | 2024-11-08 | leo_gz_worlds |
Gazebo worlds for Leo Rover simulation in ROS 2
Gazebo worlds for Leo Rover simulation in ROS 2
|
|
1 | 2024-11-08 | leo_gz_plugins |
Plugins for Leo Rover Gazebo simulation in ROS 2
Plugins for Leo Rover Gazebo simulation in ROS 2
|
|
1 | 2024-11-08 | leo_gz_bringup |
Bringup package for Leo Rover Gazebo simulation in ROS 2
Bringup package for Leo Rover Gazebo simulation in ROS 2
|
|
2 | 2024-11-08 | leo_description |
URDF Description package for Leo Rover
URDF Description package for Leo Rover
|
|
2 | 2024-11-08 | leo |
Metapackage of software for Leo Rover common to the robot and ROS desktop
Metapackage of software for Leo Rover common to the robot and ROS desktop
|
|
1 | 2024-11-07 | backward_ros |
The backward_ros package is a ros wrapper of backward-cpp from https://github.com/bombela/backward-cpp
The backward_ros package is a ros wrapper of backward-cpp from https://github.com/bombela/backward-cpp
|
|
1 | 2024-11-06 | teleop_tools_msgs |
The teleop_tools_msgs package
The teleop_tools_msgs package
|
|
1 | 2024-11-06 | teleop_tools |
A set of generic teleoperation tools for any robot.
A set of generic teleoperation tools for any robot.
|
|
2 | 2024-11-06 | plansys2_tools |
A set of tools for monitoring ROS2 Planning System
A set of tools for monitoring ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_tests |
This package contains the tests package for the ROS2 Planning System
This package contains the tests package for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_terminal |
A terminal tool for monitor and manage the ROS2 Planning System
A terminal tool for monitor and manage the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_problem_expert |
This package contains the Problem Expert module for the ROS2 Planning System
This package contains the Problem Expert module for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_popf_plan_solver |
This package contains the PDDL-based Planner module for the ROS2 Planning System
This package contains the PDDL-based Planner module for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_planner |
This package contains the PDDL-based Planner module for the ROS2 Planning System
This package contains the PDDL-based Planner module for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_pddl_parser |
This package contains a library for parsing PDDL domains and problems.
This package derives from the work of Anders Jonsson, contained in https://github.com/wisdompoet/universal-pddl-parser.git
with many modifications by Francisco Martin:
* ROS2 packaging
* Source code structure refactor
* CMakeLists.txt for cmake compilation
* Reading from String instead of files
* Licensing
This package contains a library for parsing PDDL domains and problems.
This package derives from the work of Anders Jonsson, contained in https://github.com/wisdompoet/universal-pddl-parser.git
with many modifications by Francisco Martin:
* ROS2 packaging
* Source code structure refactor
* CMakeLists.txt for cmake compilation
* Reading from String instead of files
* Licensing
|
|
2 | 2024-11-06 | plansys2_msgs |
Messages and service files for the ROS2 Planning System
Messages and service files for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_lifecycle_manager |
A controller/manager for the lifecycle nodes of the ROS2 Planning System
A controller/manager for the lifecycle nodes of the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_executor |
This package contains the Executor module for the ROS2 Planning System
This package contains the Executor module for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_domain_expert |
This package contains the Domain Expert module for the ROS2 Planning System
This package contains the Domain Expert module for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_core |
This package contains the PDDL-based core for the ROS2 Planning System
This package contains the PDDL-based core for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_bt_actions |
This package contains the Problem Expert module for the ROS2 Planning System
This package contains the Problem Expert module for the ROS2 Planning System
|
|
2 | 2024-11-06 | plansys2_bringup |
Bringup scripts and configurations for the ROS2 Planning System
Bringup scripts and configurations for the ROS2 Planning System
|
|
1 | 2024-11-06 | mouse_teleop |
A mouse teleop tool for holonomic mobile robots.
A mouse teleop tool for holonomic mobile robots.
|
|
1 | 2024-11-06 | key_teleop |
A text-based interface to send a robot movement commands.
A text-based interface to send a robot movement commands.
|
|
1 | 2024-11-06 | joy_teleop |
A (to be) generic joystick interface to control a robot
A (to be) generic joystick interface to control a robot
|
|
1 | 2024-11-06 | hri_msgs |
Messages, services and action definitions useful for Human-Robot Interaction
Messages, services and action definitions useful for Human-Robot Interaction
|
|
1 | 2024-11-06 | extrinsic_calibrator_examples |
ROS2 package designed to provide examples on how to use the extrinsic_calibrator_core package as well as useful ros2 launch files to launch the cameras, the calibrator, as well as a demonstration rviz file.
ROS2 package designed to provide examples on how to use the extrinsic_calibrator_core package as well as useful ros2 launch files to launch the cameras, the calibrator, as well as a demonstration rviz file.
|
|
1 | 2024-11-06 | extrinsic_calibrator_core |
ROS2 package designed to calibrate a set of cameras distributed throughout a room. The calibration is performed using ArUco markers scattered randomly in the environment. Each camera detects one or several ArUco markers within its field of view, and the algorithm reconstructs the positions of the markers to create a global map.
ROS2 package designed to calibrate a set of cameras distributed throughout a room. The calibration is performed using ArUco markers scattered randomly in the environment. Each camera detects one or several ArUco markers within its field of view, and the algorithm reconstructs the positions of the markers to create a global map.
|
|
1 | 2024-11-06 | extrinsic_calibrator |
ROS2 package designed to extrinsically calibrate a set of cameras distributed throughout a room.
ROS2 package designed to extrinsically calibrate a set of cameras distributed throughout a room.
|
|
1 | 2024-11-05 | pmb2_robot |
PMB2 robot description and launch files
PMB2 robot description and launch files
|
|
1 | 2024-11-05 | pmb2_description |
Mechanical, kinematic, visual, etc. description of the PMB2 robot.
The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
Mechanical, kinematic, visual, etc. description of the PMB2 robot.
The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
|
|
1 | 2024-11-05 | pmb2_controller_configuration |
Launch files and scripts needed to configure
the controllers of the PMB2 robot.
Launch files and scripts needed to configure
the controllers of the PMB2 robot.
|
|
1 | 2024-11-05 | pmb2_bringup |
Launch files and scripts needed to bring up the ROS nodes of a PMB2 robot.
Launch files and scripts needed to bring up the ROS nodes of a PMB2 robot.
|
|
1 | 2024-11-04 | tiago_moveit_config |
An automatically generated package with all the configuration and launch files for using the tiago with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the tiago with the MoveIt Motion Planning Framework
|
|
1 | 2024-11-03 | openni2_camera |
Drivers for the Asus Xtion and Primesense Devices. For using a kinect
with ROS, try the
Drivers for the Asus Xtion and Primesense Devices. For using a kinect
with ROS, try the
|
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2024-11-28 | examples_rclpy_minimal_action_server |
Examples of minimal action servers using rclpy.
Examples of minimal action servers using rclpy.
|
|
1 | 2024-11-28 | examples_rclpy_minimal_action_client |
Examples of minimal action clients using rclpy.
Examples of minimal action clients using rclpy.
|
|
1 | 2024-11-28 | examples_rclpy_guard_conditions |
Examples of using guard conditions.
Examples of using guard conditions.
|
|
1 | 2024-11-28 | examples_rclpy_executors |
Examples of creating and using exectors to run multiple nodes in the same process
Examples of creating and using exectors to run multiple nodes in the same process
|
|
1 | 2024-11-28 | examples_rclcpp_wait_set |
Example of how to use the rclcpp::WaitSet directly.
Example of how to use the rclcpp::WaitSet directly.
|
|
1 | 2024-11-28 | examples_rclcpp_multithreaded_executor |
Package containing example of how to implement a multithreaded executor
Package containing example of how to implement a multithreaded executor
|
|
1 | 2024-11-28 | examples_rclcpp_minimal_timer |
Examples of minimal nodes which have timers
Examples of minimal nodes which have timers
|
|
1 | 2024-11-28 | examples_rclcpp_minimal_subscriber |
Examples of minimal subscribers
Examples of minimal subscribers
|
|
1 | 2024-11-28 | examples_rclcpp_minimal_service |
A minimal service server which adds two numbers
A minimal service server which adds two numbers
|
|
1 | 2024-11-28 | examples_rclcpp_minimal_publisher |
Examples of minimal publisher nodes
Examples of minimal publisher nodes
|
|
1 | 2024-11-28 | examples_rclcpp_minimal_composition |
Minimalist examples of composing nodes in the same
process
Minimalist examples of composing nodes in the same
process
|
|
1 | 2024-11-28 | examples_rclcpp_minimal_client |
Examples of minimal service clients
Examples of minimal service clients
|
|
1 | 2024-11-28 | examples_rclcpp_minimal_action_server |
Minimal action server examples
Minimal action server examples
|
|
1 | 2024-11-28 | examples_rclcpp_minimal_action_client |
Minimal action client examples
Minimal action client examples
|
|
1 | 2024-11-28 | examples_rclcpp_cbg_executor |
Example for multiple Executor instances in one process, using the callback-group-level interface of the Executor class.
Example for multiple Executor instances in one process, using the callback-group-level interface of the Executor class.
|
|
1 | 2024-11-28 | examples_rclcpp_async_client |
Example of an async service client
Example of an async service client
|
|
1 | 2024-11-28 | example_interfaces |
Contains message and service definitions used by the examples.
Contains message and service definitions used by the examples.
|
|
1 | 2024-11-28 | eigen3_cmake_module |
Exports a custom CMake module to find Eigen3.
Exports a custom CMake module to find Eigen3.
|
|
1 | 2024-11-28 | console_bridge_vendor |
Wrapper around console_bridge, providing nothing but a dependency on console_bridge, on some systems.
On others, it provides an ExternalProject build of console_bridge.
Wrapper around console_bridge, providing nothing but a dependency on console_bridge, on some systems.
On others, it provides an ExternalProject build of console_bridge.
|
|
1 | 2024-11-28 | ament_xmllint |
The ability to check XML files like the package manifest using xmllint
and generate xUnit test result files.
The ability to check XML files like the package manifest using xmllint
and generate xUnit test result files.
|
|
1 | 2024-11-28 | ament_uncrustify |
The ability to check code against style conventions using uncrustify
and generate xUnit test result files.
The ability to check code against style conventions using uncrustify
and generate xUnit test result files.
|
|
1 | 2024-11-28 | ament_pyflakes |
The ability to check code using pyflakes and generate xUnit test
result files.
The ability to check code using pyflakes and generate xUnit test
result files.
|
|
1 | 2024-11-28 | ament_pycodestyle |
The ability to check code against the style conventions in PEP 8 and
generate xUnit test result files.
The ability to check code against the style conventions in PEP 8 and
generate xUnit test result files.
|
|
1 | 2024-11-28 | ament_pep257 |
The ability to check code against the docstring style conventions in
PEP 257 and generate xUnit test result files.
The ability to check code against the docstring style conventions in
PEP 257 and generate xUnit test result files.
|
|
1 | 2024-11-28 | ament_pclint |
The ability to perform static code analysis on C/C++ code using PC-lint
and generate xUnit test result files.
The ability to perform static code analysis on C/C++ code using PC-lint
and generate xUnit test result files.
|
|
1 | 2024-11-28 | ament_package |
The parser for the manifest files in the ament buildsystem.
The parser for the manifest files in the ament buildsystem.
|
|
1 | 2024-11-28 | ament_mypy |
Support for mypy static type checking in ament.
Support for mypy static type checking in ament.
|
|
1 | 2024-11-28 | ament_lint_common |
The list of commonly used linters in the ament build system in CMake.
The list of commonly used linters in the ament build system in CMake.
|
|
1 | 2024-11-28 | ament_lint_cmake |
The ability to lint CMake code using cmakelint and generate xUnit test
result files.
The ability to lint CMake code using cmakelint and generate xUnit test
result files.
|
|
1 | 2024-11-28 | ament_lint_auto |
The auto-magic functions for ease to use of the ament linters in CMake.
The auto-magic functions for ease to use of the ament linters in CMake.
|
|
1 | 2024-11-28 | ament_lint |
Providing common API for ament linter packages.
Providing common API for ament linter packages.
|
|
1 | 2024-11-28 | ament_index_python |
Python API to access the ament resource index.
Python API to access the ament resource index.
|
|
1 | 2024-11-28 | ament_index_cpp |
C++ API to access the ament resource index.
C++ API to access the ament resource index.
|
|
1 | 2024-11-28 | ament_flake8 |
The ability to check code for style and syntax conventions with flake8.
The ability to check code for style and syntax conventions with flake8.
|
|
1 | 2024-11-28 | ament_cpplint |
The ability to check code against the Google style conventions using
cpplint and generate xUnit test result files.
The ability to check code against the Google style conventions using
cpplint and generate xUnit test result files.
|
|
1 | 2024-11-28 | ament_cppcheck |
The ability to perform static code analysis on C/C++ code using Cppcheck
and generate xUnit test result files.
The ability to perform static code analysis on C/C++ code using Cppcheck
and generate xUnit test result files.
|
|
1 | 2024-11-28 | ament_copyright |
The ability to check source files for copyright and license
information.
The ability to check source files for copyright and license
information.
|
|
1 | 2024-11-28 | ament_cmake_xmllint |
The CMake API for ament_xmllint to check XML file using xmmlint.
The CMake API for ament_xmllint to check XML file using xmmlint.
|
|
1 | 2024-11-28 | ament_cmake_uncrustify |
The CMake API for ament_uncrustify to check code against styleconventions
using uncrustify.
The CMake API for ament_uncrustify to check code against styleconventions
using uncrustify.
|
|
1 | 2024-11-28 | ament_cmake_pyflakes |
The CMake API for ament_pyflakes to check code using pyflakes.
The CMake API for ament_pyflakes to check code using pyflakes.
|
|
1 | 2024-11-28 | ament_cmake_pycodestyle |
The CMake API for ament_pycodestyle to check code against the style conventions in
PEP 8.
The CMake API for ament_pycodestyle to check code against the style conventions in
PEP 8.
|
|
1 | 2024-11-28 | ament_cmake_pep257 |
The CMake API for ament_pep257 to check code against the docstring style conventions in
PEP 257.
The CMake API for ament_pep257 to check code against the docstring style conventions in
PEP 257.
|
|
1 | 2024-11-28 | ament_cmake_pclint |
The CMake API for ament_pclint to perform static code analysis on C/C++
code using PC-lint.
The CMake API for ament_pclint to perform static code analysis on C/C++
code using PC-lint.
|
|
1 | 2024-11-28 | ament_cmake_mypy |
The CMake API for ament_mypy to perform static type analysis on python code
with mypy.
The CMake API for ament_mypy to perform static type analysis on python code
with mypy.
|
|
1 | 2024-11-28 | ament_cmake_lint_cmake |
The CMake API for ament_lint_cmake to lint CMake code using cmakelint.
The CMake API for ament_lint_cmake to lint CMake code using cmakelint.
|
|
1 | 2024-11-28 | ament_cmake_flake8 |
The CMake API for ament_flake8 to check code syntax and style conventions
with flake8.
The CMake API for ament_flake8 to check code syntax and style conventions
with flake8.
|
|
1 | 2024-11-28 | ament_cmake_cpplint |
The CMake API for ament_cpplint to lint C / C++ code using cpplint.
The CMake API for ament_cpplint to lint C / C++ code using cpplint.
|
|
1 | 2024-11-28 | ament_cmake_cppcheck |
The CMake API for ament_cppcheck to perform static code analysis on C/C++
code using Cppcheck.
The CMake API for ament_cppcheck to perform static code analysis on C/C++
code using Cppcheck.
|
|
1 | 2024-11-28 | ament_cmake_copyright |
The CMake API for ament_copyright to check every source file contains copyright reference.
The CMake API for ament_copyright to check every source file contains copyright reference.
|
|
1 | 2024-11-28 | ament_cmake_clang_tidy |
The CMake API for ament_clang_tidy to lint C / C++ code using clang tidy.
The CMake API for ament_clang_tidy to lint C / C++ code using clang tidy.
|
|
1 | 2024-11-28 | ament_cmake_clang_format |
The CMake API for ament_clang_format to lint C / C++ code using clang format.
The CMake API for ament_clang_format to lint C / C++ code using clang format.
|
|
1 | 2024-11-28 | ament_clang_tidy |
The ability to check code against style conventions using
clang-tidy and generate xUnit test result files.
The ability to check code against style conventions using
clang-tidy and generate xUnit test result files.
|
|
1 | 2024-11-28 | ament_clang_format |
The ability to check code against style conventions using
clang-format and generate xUnit test result files.
The ability to check code against style conventions using
clang-format and generate xUnit test result files.
|
|
2 | 2024-11-27 | visualization_msgs |
A package containing some visualization and interaction related message definitions.
A package containing some visualization and interaction related message definitions.
|
|
1 | 2024-11-27 | type_description_interfaces |
A package containing message and service definitions for describing and communicating descriptions of other types.
A package containing message and service definitions for describing and communicating descriptions of other types.
|
|
2 | 2024-11-27 | trajectory_msgs |
A package containing some robot trajectory message definitions.
A package containing some robot trajectory message definitions.
|
|
1 | 2024-11-27 | topic_statistics_demo |
C++ demo application for topic statistics feature.
C++ demo application for topic statistics feature.
|
|
1 | 2024-11-27 | topic_monitor |
Package containing tools for monitoring ROS 2 topics.
Package containing tools for monitoring ROS 2 topics.
|
|
1 | 2024-11-27 | tlsf_cpp |
C++ stdlib-compatible wrapper around tlsf allocator and ROS2 examples
C++ stdlib-compatible wrapper around tlsf allocator and ROS2 examples
|
|
1 | 2024-11-27 | test_msgs |
A package containing message definitions and fixtures used exclusively for testing purposes.
A package containing message definitions and fixtures used exclusively for testing purposes.
|
|
2 | 2024-11-27 | stereo_msgs |
A package containing some stereo camera related message definitions.
A package containing some stereo camera related message definitions.
|
|
2 | 2024-11-27 | std_srvs |
A package containing some standard service definitions.
A package containing some standard service definitions.
|
|
2 | 2024-11-27 | std_msgs |
A package containing some standard message definitions.
A package containing some standard message definitions.
|
|
2 | 2024-11-27 | statistics_msgs |
Message definitions for reporting statistics for topics and system resources.
Message definitions for reporting statistics for topics and system resources.
|
|
1 | 2024-11-27 | spdlog_vendor |
Wrapper around spdlog, providing nothing but a dependency on spdlog, on some systems.
On others, it provides an ExternalProject build of spdlog.
Wrapper around spdlog, providing nothing but a dependency on spdlog, on some systems.
On others, it provides an ExternalProject build of spdlog.
|
|
2 | 2024-11-27 | shape_msgs |
A package containing some message definitions which describe geometric shapes.
A package containing some message definitions which describe geometric shapes.
|
|
1 | 2024-11-27 | service_msgs |
Messages definitions common among all ROS services
Messages definitions common among all ROS services
|
|
1 | 2024-11-27 | sensor_msgs_py |
A package for easy creation and reading of PointCloud2 messages in Python.
A package for easy creation and reading of PointCloud2 messages in Python.
|
|
2 | 2024-11-27 | sensor_msgs |
A package containing some sensor data related message and service definitions.
A package containing some sensor data related message and service definitions.
|
|
1 | 2024-11-27 | rttest |
Instrumentation library for real-time performance testing
Instrumentation library for real-time performance testing
|
|
1 | 2024-11-27 | rpyutils |
Package containing various utility types and functions for Python
Package containing various utility types and functions for Python
|
|
1 | 2024-11-27 | rosidl_typesupport_tests |
Test rosidl_typesupport_c and rosidl_typesupport_cpp packages
Test rosidl_typesupport_c and rosidl_typesupport_cpp packages
|
|
1 | 2024-11-27 | rosidl_typesupport_cpp |
Generate the type support for C++ messages.
Generate the type support for C++ messages.
|
|
1 | 2024-11-27 | rosidl_typesupport_c |
Generate the type support for C messages.
Generate the type support for C messages.
|
|
1 | 2024-11-27 | rosidl_runtime_py |
Runtime utilities for working with generated ROS interfaces in Python.
Runtime utilities for working with generated ROS interfaces in Python.
|
|
1 | 2024-11-27 | rosidl_generator_py |
Generate the ROS interfaces in Python.
Generate the ROS interfaces in Python.
|
|
1 | 2024-11-27 | rosidl_default_runtime |
A configuration package defining the runtime for the ROS interfaces.
A configuration package defining the runtime for the ROS interfaces.
|
|
1 | 2024-11-27 | rosidl_default_generators |
A configuration package defining the default ROS interface generators.
A configuration package defining the default ROS interface generators.
|
|
2 | 2024-11-27 | rosgraph_msgs |
Messages relating to the ROS Computation Graph.
These are generally considered to be low-level messages that end users do not interact with.
Messages relating to the ROS Computation Graph.
These are generally considered to be low-level messages that end users do not interact with.
|
|
1 | 2024-11-27 | ros_testing |
The entry point package to launch testing in ROS.
The entry point package to launch testing in ROS.
|
|
1 | 2024-11-27 | ros2test |
The test command for ROS 2 launch tests.
The test command for ROS 2 launch tests.
|
|
1 | 2024-11-27 | ros2cli_common_extensions |
Meta package for ros2cli common extensions
Meta package for ros2cli common extensions
|
|
1 | 2024-11-27 | rmw_implementation_cmake |
CMake functions which can discover and enumerate available implementations.
CMake functions which can discover and enumerate available implementations.
|
|
1 | 2024-11-27 | rmw_dds_common |
Define a common interface between DDS implementations of ROS middleware.
Define a common interface between DDS implementations of ROS middleware.
|
|
1 | 2024-11-27 | rmw |
Contains the ROS middleware API.
Contains the ROS middleware API.
|
|
1 | 2024-11-27 | rcutils |
Package containing various utility types and functions for C
Package containing various utility types and functions for C
|
|
1 | 2024-11-27 | rcl_yaml_param_parser |
Parse a YAML parameter file and populate the C data structure.
Parse a YAML parameter file and populate the C data structure.
|
|
1 | 2024-11-27 | rcl_lifecycle |
Package containing a C-based lifecycle implementation
Package containing a C-based lifecycle implementation
|
|
1 | 2024-11-27 | rcl_interfaces |
The ROS client library common interfaces.
This package contains the messages and services which ROS client libraries will use under the hood to
communicate higher level concepts such as parameters.
The ROS client library common interfaces.
This package contains the messages and services which ROS client libraries will use under the hood to
communicate higher level concepts such as parameters.
|
|
1 | 2024-11-27 | rcl_action |
Package containing a C-based ROS action implementation
Package containing a C-based ROS action implementation
|
|
1 | 2024-11-27 | rcl |
The ROS client library common implementation.
This package contains an API which builds on the ROS middleware API and is optionally built upon by the other ROS client libraries.
The ROS client library common implementation.
This package contains an API which builds on the ROS middleware API and is optionally built upon by the other ROS client libraries.
|
|
1 | 2024-11-27 | quality_of_service_demo_py |
Python Demo applications for Quality of Service features
Python Demo applications for Quality of Service features
|
|
1 | 2024-11-27 | quality_of_service_demo_cpp |
C++ Demo applications for Quality of Service features
C++ Demo applications for Quality of Service features
|
|
1 | 2024-11-27 | performance_test_fixture |
Test fixture and CMake macro for using osrf_testing_tools_cpp with Google Benchmark
Test fixture and CMake macro for using osrf_testing_tools_cpp with Google Benchmark
|
|
1 | 2024-11-27 | pendulum_msgs |
Custom messages for real-time pendulum control.
Custom messages for real-time pendulum control.
|
|
1 | 2024-11-27 | pendulum_control |
Demonstrates ROS 2's realtime capabilities with a simulated inverted pendulum.
Demonstrates ROS 2's realtime capabilities with a simulated inverted pendulum.
|
|
2 | 2024-11-27 | nav_msgs |
A package containing some navigation related message and service definitions.
A package containing some navigation related message and service definitions.
|
|
1 | 2024-11-27 | logging_demo |
Examples for using and configuring loggers.
Examples for using and configuring loggers.
|
|
1 | 2024-11-27 | lifecycle_py |
Package containing demos for rclpy lifecycle implementation
Package containing demos for rclpy lifecycle implementation
|
|
1 | 2024-11-27 | lifecycle_msgs |
A package containing some lifecycle related message and service definitions.
A package containing some lifecycle related message and service definitions.
|
|
1 | 2024-11-27 | lifecycle |
Package containing demos for lifecycle implementation
Package containing demos for lifecycle implementation
|
|
1 | 2024-11-27 | libyaml_vendor |
Vendored version of libyaml.
Vendored version of libyaml.
|
|
1 | 2024-11-27 | intra_process_demo |
Demonstrations of intra process communication.
Demonstrations of intra process communication.
|
|
1 | 2024-11-27 | image_tools |
Tools to capture and play back images to and from DDS subscriptions and publications.
Tools to capture and play back images to and from DDS subscriptions and publications.
|
|
2 | 2024-11-27 | geometry_msgs |
A package containing some geometry related message definitions.
A package containing some geometry related message definitions.
|
|
1 | 2024-11-27 | dummy_sensors |
dummy sensor nodes
dummy sensor nodes
|
|
1 | 2024-11-27 | dummy_robot_bringup |
dummy robot bringup
dummy robot bringup
|
|
1 | 2024-11-27 | dummy_map_server |
dummy map server node
dummy map server node
|
|
1 | 2024-11-27 | domain_coordinator |
A tool to coordinate unique ROS_DOMAIN_IDs across multiple processes
A tool to coordinate unique ROS_DOMAIN_IDs across multiple processes
|
|
2 | 2024-11-27 | diagnostic_msgs |
A package containing some diagnostics related message and service definitions.
A package containing some diagnostics related message and service definitions.
|
|
1 | 2024-11-27 | demo_nodes_py |
Python nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
Python nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
|
|
1 | 2024-11-27 | demo_nodes_cpp_native |
C++ nodes which access the native handles of the rmw implementation.
C++ nodes which access the native handles of the rmw implementation.
|
|
1 | 2024-11-27 | demo_nodes_cpp |
C++ nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
C++ nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
|
|
1 | 2024-11-27 | composition_interfaces |
A package containing message and service definitions for managing composable nodes in a container process.
A package containing message and service definitions for managing composable nodes in a container process.
|
|
1 | 2024-11-27 | composition |
Examples for composing multiple nodes in a single process.
Examples for composing multiple nodes in a single process.
|
|
1 | 2024-11-27 | common_interfaces |
common_interfaces contains messages and services that are widely used by other ROS packages.
common_interfaces contains messages and services that are widely used by other ROS packages.
|
|
1 | 2024-11-27 | builtin_interfaces |
A package containing message and service definitions for types defined in the OMG IDL Platform Specific Model.
A package containing message and service definitions for types defined in the OMG IDL Platform Specific Model.
|
|
1 | 2024-11-27 | ament_cmake_ros |
The ROS specific CMake bits in the ament buildsystem.
The ROS specific CMake bits in the ament buildsystem.
|
|
2 | 2024-11-27 | actionlib_msgs |
A package containing some message definitions used in the implementation of ROS 1 actions.
A package containing some message definitions used in the implementation of ROS 1 actions.
|
|
1 | 2024-11-27 | action_tutorials_py |
Python action tutorial code
Python action tutorial code
|
|
1 | 2024-11-27 | action_tutorials_interfaces |
Action tutorials action
Action tutorials action
|
|
1 | 2024-11-27 | action_tutorials_cpp |
C++ action tutorial cpp code
C++ action tutorial cpp code
|
|
1 | 2024-11-27 | action_msgs |
Messages and service definitions common among all ROS actions.
Messages and service definitions common among all ROS actions.
|
|
1 | 2024-11-26 | sdformat_vendor |
Vendor package for: sdformat14 14.6.0
SDFormat is an XML file format that describes environments, objects, and robots
in a manner suitable for robotic applications
Vendor package for: sdformat14 14.6.0
SDFormat is an XML file format that describes environments, objects, and robots
in a manner suitable for robotic applications
|
|
1 | 2024-11-26 | gz_dartsim_vendor |
Vendor package for the DART physics engine v6.13.2
Vendor package for the DART physics engine v6.13.2
|
|
1 | 2024-11-25 | zstd_image_transport |
zstd_image_transport provides a plugin to image_transport for transparently sending images
encoded as zstd blobs
zstd_image_transport provides a plugin to image_transport for transparently sending images
encoded as zstd blobs
|
|
1 | 2024-11-25 | yaets |
This package provides a execution tracing library.
This package provides a execution tracing library.
|
|
1 | 2024-11-25 | theora_image_transport |
Theora_image_transport provides a plugin to image_transport for
transparently sending an image stream encoded with the Theora codec.
Theora_image_transport provides a plugin to image_transport for
transparently sending an image stream encoded with the Theora codec.
|
|
1 | 2024-11-25 | raspimouse_ros2_examples |
Raspberry Pi Mouse examples
Raspberry Pi Mouse examples
|
|
1 | 2024-11-25 | log_view |
The log_view package provides a ncurses based terminal GUI for
viewing and filtering published ROS log messages.
This is an alternative to rqt_console and swri_console that doesn't depend
on qt and can be run directly in a terminal.
The log_view package provides a ncurses based terminal GUI for
viewing and filtering published ROS log messages.
This is an alternative to rqt_console and swri_console that doesn't depend
on qt and can be run directly in a terminal.
|
|
1 | 2024-11-25 | image_transport_plugins |
A set of plugins for publishing and subscribing to sensor_msgs/Image topics
in representations other than raw pixel data. For example, for viewing a
stream of images off-robot, a video codec will give much lower bandwidth
and latency. For low frame rate tranport of high-definition images, you
might prefer sending them as JPEG or PNG-compressed form.
A set of plugins for publishing and subscribing to sensor_msgs/Image topics
in representations other than raw pixel data. For example, for viewing a
stream of images off-robot, a video codec will give much lower bandwidth
and latency. For low frame rate tranport of high-definition images, you
might prefer sending them as JPEG or PNG-compressed form.
|
|
1 | 2024-11-25 | compressed_image_transport |
Compressed_image_transport provides a plugin to image_transport for transparently sending images
encoded as JPEG or PNG.
Compressed_image_transport provides a plugin to image_transport for transparently sending images
encoded as JPEG or PNG.
|
|
1 | 2024-11-25 | compressed_depth_image_transport |
Compressed_depth_image_transport provides a plugin to image_transport for transparently sending
depth images (raw, floating-point) using PNG compression.
Compressed_depth_image_transport provides a plugin to image_transport for transparently sending
depth images (raw, floating-point) using PNG compression.
|
|
1 | 2024-11-24 | plotjuggler |
PlotJuggler: juggle with data
PlotJuggler: juggle with data
|
|
1 | 2024-11-24 | hatchbed_common |
Common Hatchbed C++ utility code for ROS, such registering and handling updates to ros parameters.
Common Hatchbed C++ utility code for ROS, such registering and handling updates to ros parameters.
|
|
1 | 2024-11-24 | clips_vendor |
Vendor package for the CLIPS rule based production system
Vendor package for the CLIPS rule based production system
|
|
1 | 2024-11-23 | magic_enum |
Static reflection for enums (to string, from string, iteration) for modern C++,
work with any enum type without any macro or boilerplate code
Static reflection for enums (to string, from string, iteration) for modern C++,
work with any enum type without any macro or boilerplate code
|
|
1 | 2024-11-23 | dual_laser_merger |
merge dual lidar's scans.
merge dual lidar's scans.
|
|
1 | 2024-11-22 | rosbag2_to_video |
Command line tool to create a video from a rosbag recording
Command line tool to create a video from a rosbag recording
|
|
1 | 2024-11-22 | microstrain_inertial_rqt |
The microstrain_inertial_rqt package provides several RQT widgets to view the status of Microstrain devices
The microstrain_inertial_rqt package provides several RQT widgets to view the status of Microstrain devices
|
|
1 | 2024-11-22 | microstrain_inertial_msgs |
A package that contains ROS message corresponding to microstrain message types.
A package that contains ROS message corresponding to microstrain message types.
|
|
1 | 2024-11-22 | microstrain_inertial_examples |
Simple examples using the microstrain_inertial_driver for MicroStrain sensors.
Simple examples using the microstrain_inertial_driver for MicroStrain sensors.
|
|
1 | 2024-11-22 | microstrain_inertial_driver |
The ros_mscl package provides a driver for the LORD/Microstrain inertial products.
The ros_mscl package provides a driver for the LORD/Microstrain inertial products.
|
|
1 | 2024-11-22 | microstrain_inertial_description |
URDF and stl files for MicroStrain sensors.
URDF and stl files for MicroStrain sensors.
|
|
1 | 2024-11-21 | spinnaker_synchronized_camera_driver |
ROS2 driver for synchronized flir cameras using the Spinnaker SDK
ROS2 driver for synchronized flir cameras using the Spinnaker SDK
|
|
1 | 2024-11-21 | spinnaker_camera_driver |
ROS2 driver for flir spinnaker sdk
ROS2 driver for flir spinnaker sdk
|
|
1 | 2024-11-21 | simple_launch |
Python helper class for the ROS 2 launch system
Python helper class for the ROS 2 launch system
|
|
2 | 2024-11-21 | reach_ros |
The reach_ros package
The reach_ros package
|
|
1 | 2024-11-21 | flir_camera_msgs |
messages related to flir camera driver
messages related to flir camera driver
|
|
1 | 2024-11-21 | flir_camera_description |
FLIR camera Description package
FLIR camera Description package
|
|
1 | 2024-11-19 | rmf_workcell_msgs |
A package containing messages used by all workcells generically to interfact with rmf_core
A package containing messages used by all workcells generically to interfact with rmf_core
|
|
1 | 2024-11-19 | rmf_traffic_msgs |
A package containing messages used by the RMF traffic management system.
A package containing messages used by the RMF traffic management system.
|
|
1 | 2024-11-19 | rmf_task_msgs |
A package containing messages used to specify tasks
A package containing messages used to specify tasks
|
|
1 | 2024-11-19 | rmf_site_map_msgs |
Messages that contain GeoPackage maps
Messages that contain GeoPackage maps
|
|
1 | 2024-11-19 | rmf_scheduler_msgs |
Messages used by rmf_scheduler_msgs
Messages used by rmf_scheduler_msgs
|
|
1 | 2024-11-19 | rmf_obstacle_msgs |
A package containing messages for describing obstacles in the environment
A package containing messages for describing obstacles in the environment
|
|
1 | 2024-11-19 | rmf_lift_msgs |
Messages used to interface to lifts.
Messages used to interface to lifts.
|
|
1 | 2024-11-19 | rmf_ingestor_msgs |
A package containing messages used to interface to ingestor workcells
A package containing messages used to interface to ingestor workcells
|
|
1 | 2024-11-19 | rmf_fleet_msgs |
A package containing messages used to interface to fleet managers
A package containing messages used to interface to fleet managers
|
|
1 | 2024-11-19 | rmf_door_msgs |
Messages used to interface to doors
Messages used to interface to doors
|
|
1 | 2024-11-19 | rmf_dispenser_msgs |
A package containing messages used to interface to dispenser workcells
A package containing messages used to interface to dispenser workcells
|
|
1 | 2024-11-19 | rmf_charger_msgs |
This package contains messages regarding charging and discharging
This package contains messages regarding charging and discharging
|
|
1 | 2024-11-19 | qml_ros2_plugin |
A QML plugin for ROS.
Enables full communication with ROS from QML.
A QML plugin for ROS.
Enables full communication with ROS from QML.
|
|
1 | 2024-11-19 | odom_to_tf_ros2 |
A simple ros2 package (node) that reads an odom topic and generates the equivalent tf connection (transformation). It also provides options to override frame names, or just use the ones in the original odom topic.
A simple ros2 package (node) that reads an odom topic and generates the equivalent tf connection (transformation). It also provides options to override frame names, or just use the ones in the original odom topic.
|
|
1 | 2024-11-19 | interactive_marker_twist_server |
Interactive control for generic Twist-based robots using interactive markers
Interactive control for generic Twist-based robots using interactive markers
|
|
1 | 2024-11-19 | fields2cover |
Robust and efficient coverage paths for autonomous agricultural vehicles.
A modular and extensible Coverage Path Planning library
Robust and efficient coverage paths for autonomous agricultural vehicles.
A modular and extensible Coverage Path Planning library
|
|
1 | 2024-11-18 | neo_nav2_bringup |
ROS-2 navigation bringup packages for neobotix robots
ROS-2 navigation bringup packages for neobotix robots
|
|
2 | 2024-11-18 | leo_robot |
Metapackage of software to install on Leo Rover.
Metapackage of software to install on Leo Rover.
|
|
2 | 2024-11-18 | leo_fw |
Binary releases of Leo Rover firmware and related utilities
Binary releases of Leo Rover firmware and related utilities
|
|
2 | 2024-11-18 | leo_bringup |
Scripts and launch files for starting basic Leo Rover functionalities.
Scripts and launch files for starting basic Leo Rover functionalities.
|
|
1 | 2024-11-18 | foxglove_compressed_video_transport |
foxglove_compressed_video_transport provides a plugin to image_transport for
transparently sending an image stream encoded in foxglove compressed video packets.
foxglove_compressed_video_transport provides a plugin to image_transport for
transparently sending an image stream encoded in foxglove compressed video packets.
|
|
1 | 2024-11-16 | twist_stamper |
ROS2 package for converting between Twist and TwistStamped messages
ROS2 package for converting between Twist and TwistStamped messages
|
|
1 | 2024-11-16 | joy_tester |
Simple GUI tool for testing joysticks/gamepads
Simple GUI tool for testing joysticks/gamepads
|
|
1 | 2024-11-15 | gz_common_vendor |
Vendor package for: gz-common5 5.7.0
Gazebo Common : AV, Graphics, Events, and much more.
Vendor package for: gz-common5 5.7.0
Gazebo Common : AV, Graphics, Events, and much more.
|
|
1 | 2024-11-14 | kompass_interfaces |
ROS2 Interfaces for Kompass
ROS2 Interfaces for Kompass
|
|
1 | 2024-11-14 | kompass |
Kompass: Event-driven navigation system
Kompass: Event-driven navigation system
|
|
1 | 2024-11-13 | xacro |
Xacro (XML Macros)
Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
Xacro (XML Macros)
Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
|
|
1 | 2024-11-13 | jacro |
TODO: Project Short Description
TODO: Project Short Description
|
|
1 | 2024-11-13 | feetech_ros2_driver |
ros2_control hardware interface for Feetech Servos
ros2_control hardware interface for Feetech Servos
|
|
1 | 2024-11-12 | gz_sensors_vendor |
Vendor package for: gz-sensors8 8.2.1
Gazebo Sensors : Sensor models for simulation
Vendor package for: gz-sensors8 8.2.1
Gazebo Sensors : Sensor models for simulation
|
|
1 | 2024-11-12 | gz_physics_vendor |
Vendor package for: gz-physics7 7.4.0
Gazebo Physics : Physics classes and functions for robot applications
Vendor package for: gz-physics7 7.4.0
Gazebo Physics : Physics classes and functions for robot applications
|
|
1 | 2024-11-12 | gz_msgs_vendor |
Vendor package for: gz-msgs10 10.3.1
Gazebo Messages: Protobuf messages and functions for robot applications
Vendor package for: gz-msgs10 10.3.1
Gazebo Messages: Protobuf messages and functions for robot applications
|
|
1 | 2024-11-12 | gz_math_vendor |
Vendor package for: gz-math7 7.5.1
Gazebo Math : Math classes and functions for robot applications
Vendor package for: gz-math7 7.5.1
Gazebo Math : Math classes and functions for robot applications
|
|
1 | 2024-11-12 | cyclonedds |
Eclipse Cyclone DDS is a very performant and robust open-source DDS implementation. Cyclone DDS is developed completely in the open as an Eclipse IoT project.
Eclipse Cyclone DDS is a very performant and robust open-source DDS implementation. Cyclone DDS is developed completely in the open as an Eclipse IoT project.
|
|
1 | 2024-11-11 | urdfdom_py |
Python implementation of the URDF parser.
Python implementation of the URDF parser.
|
|
1 | 2024-11-10 | data_tamer_msgs |
Interfaces for data_tamer
Interfaces for data_tamer
|
|
1 | 2024-11-10 | data_tamer_cpp |
DataTamer data logging library
DataTamer data logging library
|
|
1 | 2024-11-08 | simple_grasping |
Basic grasping applications and demos.
Basic grasping applications and demos.
|
|
1 | 2024-11-08 | raspimouse_description |
The raspimouse_description package
The raspimouse_description package
|
|
2 | 2024-11-08 | octomap_msgs |
This package provides messages and serializations / conversion for the
This package provides messages and serializations / conversion for the
|
|
2 | 2024-11-08 | leo_teleop |
Scripts and launch files for Leo Rover teleoperation
Scripts and launch files for Leo Rover teleoperation
|
|
2 | 2024-11-08 | leo_simulator |
Metapackage for Leo Rover Gazebo simulation in ROS2
Metapackage for Leo Rover Gazebo simulation in ROS2
|
|
2 | 2024-11-08 | leo_msgs |
Message and Service definitions for Leo Rover
Message and Service definitions for Leo Rover
|
|
1 | 2024-11-08 | leo_gz_worlds |
Gazebo worlds for Leo Rover simulation in ROS 2
Gazebo worlds for Leo Rover simulation in ROS 2
|
|
1 | 2024-11-08 | leo_gz_plugins |
Plugins for Leo Rover Gazebo simulation in ROS 2
Plugins for Leo Rover Gazebo simulation in ROS 2
|
|
1 | 2024-11-08 | leo_gz_bringup |
Bringup package for Leo Rover Gazebo simulation in ROS 2
Bringup package for Leo Rover Gazebo simulation in ROS 2
|
|
2 | 2024-11-08 | leo_description |
URDF Description package for Leo Rover
URDF Description package for Leo Rover
|
|
2 | 2024-11-08 | leo |
Metapackage of software for Leo Rover common to the robot and ROS desktop
Metapackage of software for Leo Rover common to the robot and ROS desktop
|
|
1 | 2024-11-08 | gz_sim_vendor |
Vendor package for: gz-sim8 8.7.0
Gazebo Sim : A Robotic Simulator
Vendor package for: gz-sim8 8.7.0
Gazebo Sim : A Robotic Simulator
|
|
1 | 2024-11-08 | gz_rendering_vendor |
Vendor package for: gz-rendering8 8.2.1
Gazebo Rendering: Rendering library for robot applications
Vendor package for: gz-rendering8 8.2.1
Gazebo Rendering: Rendering library for robot applications
|
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2024-11-26 | dummy_map_server |
dummy map server node
dummy map server node
|
|
1 | 2024-11-26 | demo_nodes_py |
Python nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
Python nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
|
|
1 | 2024-11-26 | demo_nodes_cpp_native |
C++ nodes which access the native handles of the rmw implementation.
C++ nodes which access the native handles of the rmw implementation.
|
|
1 | 2024-11-26 | demo_nodes_cpp |
C++ nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
C++ nodes which were previously in the ros2/examples repository but are now just used for demo purposes.
|
|
1 | 2024-11-26 | composition |
Examples for composing multiple nodes in a single process.
Examples for composing multiple nodes in a single process.
|
|
1 | 2024-11-26 | action_tutorials_py |
Python action tutorial code
Python action tutorial code
|
|
1 | 2024-11-26 | action_tutorials_cpp |
C++ action tutorial cpp code
C++ action tutorial cpp code
|
|
1 | 2024-11-25 | log_view |
The log_view package provides a ncurses based terminal GUI for
viewing and filtering published ROS log messages.
This is an alternative to rqt_console and swri_console that doesn't depend
on qt and can be run directly in a terminal.
The log_view package provides a ncurses based terminal GUI for
viewing and filtering published ROS log messages.
This is an alternative to rqt_console and swri_console that doesn't depend
on qt and can be run directly in a terminal.
|
|
1 | 2024-11-24 | plotjuggler |
PlotJuggler: juggle with data
PlotJuggler: juggle with data
|
|
1 | 2024-11-24 | hatchbed_common |
Common Hatchbed C++ utility code for ROS, such registering and handling updates to ros parameters.
Common Hatchbed C++ utility code for ROS, such registering and handling updates to ros parameters.
|
|
1 | 2024-11-24 | clips_vendor |
Vendor package for the CLIPS rule based production system
Vendor package for the CLIPS rule based production system
|
|
1 | 2024-11-23 | magic_enum |
Static reflection for enums (to string, from string, iteration) for modern C++,
work with any enum type without any macro or boilerplate code
Static reflection for enums (to string, from string, iteration) for modern C++,
work with any enum type without any macro or boilerplate code
|
|
1 | 2024-11-22 | rosbag2_to_video |
Command line tool to create a video from a rosbag recording
Command line tool to create a video from a rosbag recording
|
|
1 | 2024-11-22 | microstrain_inertial_rqt |
The microstrain_inertial_rqt package provides several RQT widgets to view the status of Microstrain devices
The microstrain_inertial_rqt package provides several RQT widgets to view the status of Microstrain devices
|
|
1 | 2024-11-22 | microstrain_inertial_msgs |
A package that contains ROS message corresponding to microstrain message types.
A package that contains ROS message corresponding to microstrain message types.
|
|
1 | 2024-11-22 | microstrain_inertial_examples |
Simple examples using the microstrain_inertial_driver for MicroStrain sensors.
Simple examples using the microstrain_inertial_driver for MicroStrain sensors.
|
|
1 | 2024-11-22 | microstrain_inertial_driver |
The ros_mscl package provides a driver for the LORD/Microstrain inertial products.
The ros_mscl package provides a driver for the LORD/Microstrain inertial products.
|
|
1 | 2024-11-22 | microstrain_inertial_description |
URDF and stl files for MicroStrain sensors.
URDF and stl files for MicroStrain sensors.
|
|
1 | 2024-11-22 | dual_laser_merger |
merge dual lidar's scans.
merge dual lidar's scans.
|
|
1 | 2024-11-21 | spinnaker_synchronized_camera_driver |
ROS2 driver for synchronized flir cameras using the Spinnaker SDK
ROS2 driver for synchronized flir cameras using the Spinnaker SDK
|
|
1 | 2024-11-21 | spinnaker_camera_driver |
ROS2 driver for flir spinnaker sdk
ROS2 driver for flir spinnaker sdk
|
|
1 | 2024-11-21 | simple_launch |
Python helper class for the ROS 2 launch system
Python helper class for the ROS 2 launch system
|
|
2 | 2024-11-21 | reach_ros |
The reach_ros package
The reach_ros package
|
|
1 | 2024-11-21 | flir_camera_msgs |
messages related to flir camera driver
messages related to flir camera driver
|
|
1 | 2024-11-21 | flir_camera_description |
FLIR camera Description package
FLIR camera Description package
|
|
1 | 2024-11-20 | rosidl_dynamic_typesupport_fastrtps |
FastDDS serialization support implementation for use with C/C++.
FastDDS serialization support implementation for use with C/C++.
|
|
1 | 2024-11-20 | rosidl_dynamic_typesupport |
Unified serialization support interface for dynamic typesupport in C.
Unified serialization support interface for dynamic typesupport in C.
|
|
1 | 2024-11-19 | qml_ros2_plugin |
A QML plugin for ROS.
Enables full communication with ROS from QML.
A QML plugin for ROS.
Enables full communication with ROS from QML.
|
|
1 | 2024-11-19 | odom_to_tf_ros2 |
A simple ros2 package (node) that reads an odom topic and generates the equivalent tf connection (transformation). It also provides options to override frame names, or just use the ones in the original odom topic.
A simple ros2 package (node) that reads an odom topic and generates the equivalent tf connection (transformation). It also provides options to override frame names, or just use the ones in the original odom topic.
|
|
1 | 2024-11-19 | interactive_marker_twist_server |
Interactive control for generic Twist-based robots using interactive markers
Interactive control for generic Twist-based robots using interactive markers
|
|
1 | 2024-11-19 | fields2cover |
Robust and efficient coverage paths for autonomous agricultural vehicles.
A modular and extensible Coverage Path Planning library
Robust and efficient coverage paths for autonomous agricultural vehicles.
A modular and extensible Coverage Path Planning library
|
|
1 | 2024-11-18 | mini_tof_interfaces |
Message definitions for the mini_tof package.
Message definitions for the mini_tof package.
|
|
1 | 2024-11-18 | mini_tof |
ROS 2 Package for interfacing with miniature ToF sensors
ROS 2 Package for interfacing with miniature ToF sensors
|
|
2 | 2024-11-18 | leo_robot |
Metapackage of software to install on Leo Rover.
Metapackage of software to install on Leo Rover.
|
|
2 | 2024-11-18 | leo_fw |
Binary releases of Leo Rover firmware and related utilities
Binary releases of Leo Rover firmware and related utilities
|
|
2 | 2024-11-18 | leo_bringup |
Scripts and launch files for starting basic Leo Rover functionalities.
Scripts and launch files for starting basic Leo Rover functionalities.
|
|
1 | 2024-11-18 | foxglove_compressed_video_transport |
foxglove_compressed_video_transport provides a plugin to image_transport for
transparently sending an image stream encoded in foxglove compressed video packets.
foxglove_compressed_video_transport provides a plugin to image_transport for
transparently sending an image stream encoded in foxglove compressed video packets.
|
|
1 | 2024-11-16 | twist_stamper |
ROS2 package for converting between Twist and TwistStamped messages
ROS2 package for converting between Twist and TwistStamped messages
|
|
1 | 2024-11-16 | joy_tester |
Simple GUI tool for testing joysticks/gamepads
Simple GUI tool for testing joysticks/gamepads
|
|
1 | 2024-11-14 | kompass_interfaces |
ROS2 Interfaces for Kompass
ROS2 Interfaces for Kompass
|
|
1 | 2024-11-14 | kompass |
Kompass: Event-driven navigation system
Kompass: Event-driven navigation system
|
|
1 | 2024-11-13 | xacro |
Xacro (XML Macros)
Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
Xacro (XML Macros)
Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
|
|
1 | 2024-11-13 | rmf_workcell_msgs |
A package containing messages used by all workcells generically to interfact with rmf_core
A package containing messages used by all workcells generically to interfact with rmf_core
|
|
1 | 2024-11-13 | rmf_traffic_msgs |
A package containing messages used by the RMF traffic management system.
A package containing messages used by the RMF traffic management system.
|
|
1 | 2024-11-13 | rmf_task_msgs |
A package containing messages used to specify tasks
A package containing messages used to specify tasks
|
|
1 | 2024-11-13 | rmf_site_map_msgs |
Messages that contain GeoPackage maps
Messages that contain GeoPackage maps
|
|
1 | 2024-11-13 | rmf_scheduler_msgs |
Messages used by rmf_scheduler_msgs
Messages used by rmf_scheduler_msgs
|
|
1 | 2024-11-13 | rmf_reservation_msgs |
Messages for the reservation and queueing system
Messages for the reservation and queueing system
|
|
1 | 2024-11-13 | rmf_obstacle_msgs |
A package containing messages for describing obstacles in the environment
A package containing messages for describing obstacles in the environment
|
|
1 | 2024-11-13 | rmf_lift_msgs |
Messages used to interface to lifts.
Messages used to interface to lifts.
|
|
1 | 2024-11-13 | rmf_ingestor_msgs |
A package containing messages used to interface to ingestor workcells
A package containing messages used to interface to ingestor workcells
|
|
1 | 2024-11-13 | rmf_fleet_msgs |
A package containing messages used to interface to fleet managers
A package containing messages used to interface to fleet managers
|
|
1 | 2024-11-13 | rmf_door_msgs |
Messages used to interface to doors
Messages used to interface to doors
|
|
1 | 2024-11-13 | rmf_dispenser_msgs |
A package containing messages used to interface to dispenser workcells
A package containing messages used to interface to dispenser workcells
|
|
1 | 2024-11-13 | rmf_charger_msgs |
This package contains messages regarding charging and discharging
This package contains messages regarding charging and discharging
|
|
1 | 2024-11-13 | jacro |
TODO: Project Short Description
TODO: Project Short Description
|
|
1 | 2024-11-13 | feetech_ros2_driver |
ros2_control hardware interface for Feetech Servos
ros2_control hardware interface for Feetech Servos
|
|
1 | 2024-11-12 | gz_cmake_vendor |
Vendor package for: gz-cmake4 4.1.0
Gazebo CMake : CMake Modules for Gazebo Projects
Vendor package for: gz-cmake4 4.1.0
Gazebo CMake : CMake Modules for Gazebo Projects
|
|
1 | 2024-11-12 | cyclonedds |
Eclipse Cyclone DDS is a very performant and robust open-source DDS implementation. Cyclone DDS is developed completely in the open as an Eclipse IoT project.
Eclipse Cyclone DDS is a very performant and robust open-source DDS implementation. Cyclone DDS is developed completely in the open as an Eclipse IoT project.
|
|
1 | 2024-11-11 | urdfdom_py |
Python implementation of the URDF parser.
Python implementation of the URDF parser.
|
|
1 | 2024-11-10 | data_tamer_msgs |
Interfaces for data_tamer
Interfaces for data_tamer
|
|
1 | 2024-11-10 | data_tamer_cpp |
DataTamer data logging library
DataTamer data logging library
|
|
1 | 2024-11-08 | simple_grasping |
Basic grasping applications and demos.
Basic grasping applications and demos.
|
|
2 | 2024-11-08 | octomap_msgs |
This package provides messages and serializations / conversion for the
This package provides messages and serializations / conversion for the
|
|
2 | 2024-11-08 | leo_teleop |
Scripts and launch files for Leo Rover teleoperation
Scripts and launch files for Leo Rover teleoperation
|
|
2 | 2024-11-08 | leo_simulator |
Metapackage for Leo Rover Gazebo simulation in ROS2
Metapackage for Leo Rover Gazebo simulation in ROS2
|
|
2 | 2024-11-08 | leo_msgs |
Message and Service definitions for Leo Rover
Message and Service definitions for Leo Rover
|
|
1 | 2024-11-08 | leo_gz_worlds |
Gazebo worlds for Leo Rover simulation in ROS 2
Gazebo worlds for Leo Rover simulation in ROS 2
|
|
1 | 2024-11-08 | leo_gz_plugins |
Plugins for Leo Rover Gazebo simulation in ROS 2
Plugins for Leo Rover Gazebo simulation in ROS 2
|
|
1 | 2024-11-08 | leo_gz_bringup |
Bringup package for Leo Rover Gazebo simulation in ROS 2
Bringup package for Leo Rover Gazebo simulation in ROS 2
|
|
2 | 2024-11-08 | leo_description |
URDF Description package for Leo Rover
URDF Description package for Leo Rover
|
|
2 | 2024-11-08 | leo |
Metapackage of software for Leo Rover common to the robot and ROS desktop
Metapackage of software for Leo Rover common to the robot and ROS desktop
|
|
1 | 2024-11-07 | rt_usb_9axisimu_driver |
The rt_usb_9axisimu_driver package
The rt_usb_9axisimu_driver package
|
|
1 | 2024-11-07 | backward_ros |
The backward_ros package is a ros wrapper of backward-cpp from https://github.com/bombela/backward-cpp
The backward_ros package is a ros wrapper of backward-cpp from https://github.com/bombela/backward-cpp
|
|
1 | 2024-11-06 | teleop_tools_msgs |
The teleop_tools_msgs package
The teleop_tools_msgs package
|
|
1 | 2024-11-06 | teleop_tools |
A set of generic teleoperation tools for any robot.
A set of generic teleoperation tools for any robot.
|
|
1 | 2024-11-06 | mouse_teleop |
A mouse teleop tool for holonomic mobile robots.
A mouse teleop tool for holonomic mobile robots.
|
|
1 | 2024-11-06 | key_teleop |
A text-based interface to send a robot movement commands.
A text-based interface to send a robot movement commands.
|
|
1 | 2024-11-06 | joy_teleop |
A (to be) generic joystick interface to control a robot
A (to be) generic joystick interface to control a robot
|
|
2 | 2024-11-05 | raspimouse_msgs |
RaspiMouse messages
RaspiMouse messages
|
|
2 | 2024-11-05 | raspimouse |
RaspiMouse ROS 2 node
RaspiMouse ROS 2 node
|
|
1 | 2024-11-03 | openni2_camera |
Drivers for the Asus Xtion and Primesense Devices. For using a kinect
with ROS, try the
Drivers for the Asus Xtion and Primesense Devices. For using a kinect
with ROS, try the
|
|
1 | 2024-10-31 | velodyne_pointcloud |
Point cloud conversions for Velodyne 3D LIDARs.
Point cloud conversions for Velodyne 3D LIDARs.
|
|
1 | 2024-10-31 | velodyne_msgs |
ROS message definitions for Velodyne 3D LIDARs.
ROS message definitions for Velodyne 3D LIDARs.
|
|
1 | 2024-10-31 | velodyne_laserscan |
Extract a single ring of a Velodyne PointCloud2 and publish it as a LaserScan message
Extract a single ring of a Velodyne PointCloud2 and publish it as a LaserScan message
|
|
1 | 2024-10-31 | velodyne_driver |
ROS device driver for Velodyne 3D LIDARs.
ROS device driver for Velodyne 3D LIDARs.
|
|
1 | 2024-10-31 | velodyne |
Basic ROS support for the Velodyne 3D LIDARs.
Basic ROS support for the Velodyne 3D LIDARs.
|
|
1 | 2024-10-30 | rclc_parameter |
Parameter server implementation for micro-ROS nodes
Parameter server implementation for micro-ROS nodes
|
|
1 | 2024-10-30 | rclc_lifecycle |
rclc lifecycle convenience methods.
rclc lifecycle convenience methods.
|
|
1 | 2024-10-30 | rclc_examples |
Example of using rclc_executor
Example of using rclc_executor
|
|
1 | 2024-10-30 | rclc |
The ROS client library in C.
The ROS client library in C.
|
|
1 | 2024-10-29 | turtle_nest |
ROS 2 Package Creator
ROS 2 Package Creator
|
|
1 | 2024-10-29 | gz_tools_vendor |
Vendor package for: gz-tools2 2.0.1
Gazebo Tools: Entrypoint to Gazebo's command line interface
Vendor package for: gz-tools2 2.0.1
Gazebo Tools: Entrypoint to Gazebo's command line interface
|
|
1 | 2024-10-28 | mqtt_client_interfaces |
Message and service definitions for mqtt_client
Message and service definitions for mqtt_client
|
|
1 | 2024-10-28 | mqtt_client |
Node that enables connected ROS-based devices or robots to exchange ROS messages via an MQTT broker using the MQTT protocol.
Node that enables connected ROS-based devices or robots to exchange ROS messages via an MQTT broker using the MQTT protocol.
|
|
1 | 2024-10-26 | pose_cov_ops |
C++ library for SE(2)/SE(3) pose composition operations with uncertainty
C++ library for SE(2)/SE(3) pose composition operations with uncertainty
|
|
1 | 2024-10-25 | lanelet2_validation |
Package for sanitizing lanelet maps
Package for sanitizing lanelet maps
|
|
1 | 2024-10-25 | lanelet2_traffic_rules |
Package for interpreting traffic rules in a lanelet map
Package for interpreting traffic rules in a lanelet map
|
|
1 | 2024-10-25 | lanelet2_routing |
Routing module for lanelet2
Routing module for lanelet2
|
|
1 | 2024-10-25 | lanelet2_python |
Python bindings for lanelet2
Python bindings for lanelet2
|
|
1 | 2024-10-25 | lanelet2_projection |
Lanelet2 projection library for lat/lon to local x/y conversion
Lanelet2 projection library for lat/lon to local x/y conversion
|
|
1 | 2024-10-25 | lanelet2_matching |
Library to match objects to lanelets
Library to match objects to lanelets
|
|
1 | 2024-10-25 | lanelet2_maps |
Example maps in the lanelet2-format
Example maps in the lanelet2-format
|
|
1 | 2024-10-25 | lanelet2_io |
Parser/Writer module for lanelet2
Parser/Writer module for lanelet2
|
|
1 | 2024-10-25 | lanelet2_examples |
Examples for working with Lanelet2
Examples for working with Lanelet2
|
|
1 | 2024-10-25 | lanelet2_core |
Lanelet2 core module
Lanelet2 core module
|
|
1 | 2024-10-25 | lanelet2 |
Meta-package for lanelet2
Meta-package for lanelet2
|
|
1 | 2024-10-23 | mavros_msgs |
mavros_msgs defines messages for
mavros_msgs defines messages for
|
|
1 | 2024-10-23 | mavros_extras |
Extra nodes and plugins for
Extra nodes and plugins for
|
|
1 | 2024-10-23 | mavros |
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
|
|
1 | 2024-10-23 | libmavconn |
MAVLink communication library.
This library provide unified connection handling classes
and URL to connection object mapper.
This library can be used in standalone programs.
MAVLink communication library.
This library provide unified connection handling classes
and URL to connection object mapper.
This library can be used in standalone programs.
|
|
1 | 2024-10-22 | simple_actions |
Simple library for using the `rclpy/rclcpp` action libraries
Simple library for using the `rclpy/rclcpp` action libraries
|
|
1 | 2024-10-19 | octomap_rviz_plugins |
A set of plugins for displaying occupancy information decoded from binary octomap messages.
A set of plugins for displaying occupancy information decoded from binary octomap messages.
|
|
1 | 2024-10-18 | robotiq_hardware_tests |
ROS2 driver for the Robotiq gripper.
ROS2 driver for the Robotiq gripper.
|
|
1 | 2024-10-18 | robotiq_driver |
ROS2 driver package for the Robotiq gripper.
ROS2 driver package for the Robotiq gripper.
|
|
1 | 2024-10-18 | robotiq_description |
URDF and xacro description package for the Robotiq gripper.
URDF and xacro description package for the Robotiq gripper.
|
|
1 | 2024-10-18 | robotiq_controllers |
Controllers for the Robotiq gripper.
Controllers for the Robotiq gripper.
|
|
1 | 2024-10-17 | srdfdom |
Parser for Semantic Robot Description Format (SRDF).
Parser for Semantic Robot Description Format (SRDF).
|
|
1 | 2024-10-17 | moveit_msgs |
Messages, services and actions used by MoveIt
Messages, services and actions used by MoveIt
|
|
1 | 2024-10-17 | foonathan_memory_vendor |
Foonathan/memory vendor package for Fast-RTPS.
Foonathan/memory vendor package for Fast-RTPS.
|
|
1 | 2024-10-16 | laser_segmentation |
Implementation of algorithms for segmentation of laserscans.
Implementation of algorithms for segmentation of laserscans.
|
|
1 | 2024-10-14 | topic_tools_interfaces |
topic_tools_interfaces contains messages and services for topic_tools
topic_tools_interfaces contains messages and services for topic_tools
|
|
2 | 2024-10-14 | topic_tools |
Tools for directing, throttling, selecting, and otherwise messing with
ROS 2 topics at a meta level.
Tools for directing, throttling, selecting, and otherwise messing with
ROS 2 topics at a meta level.
|
|
1 | 2024-10-14 | random_numbers |
This library contains wrappers for generating floating point values, integers, quaternions using boost libraries.
The constructor of the wrapper is guaranteed to be thread safe and initialize its random number generator to a random seed.
Seeds are obtained using a separate and different random number generator.
This library contains wrappers for generating floating point values, integers, quaternions using boost libraries.
The constructor of the wrapper is guaranteed to be thread safe and initialize its random number generator to a random seed.
Seeds are obtained using a separate and different random number generator.
|
|
1 | 2024-10-14 | mrpt_path_planning |
Path planning and navigation algorithms for robots/vehicles moving on planar environments. This library builds upon mrpt-nav and the theory behind PTGs to generate libraries of "motion primitives" for vehicles with arbitrary shape and realistic kinematics and dynamics.
Path planning and navigation algorithms for robots/vehicles moving on planar environments. This library builds upon mrpt-nav and the theory behind PTGs to generate libraries of "motion primitives" for vehicles with arbitrary shape and realistic kinematics and dynamics.
|
|
1 | 2024-10-13 | warehouse_ros_sqlite |
Implementation of warehouse_ros for sqlite
Implementation of warehouse_ros for sqlite
|
|
1 | 2024-10-13 | py_binding_tools |
Python binding tools for C++
Python binding tools for C++
|
|
1 | 2024-10-10 | openeb_vendor |
Wrapper around openeb
Wrapper around openeb
|
|
1 | 2024-10-10 | gz_msgs_vendor |
Vendor package for: gz-msgs11 11.0.1
Gazebo Messages: Protobuf messages and functions for robot applications
Vendor package for: gz-msgs11 11.0.1
Gazebo Messages: Protobuf messages and functions for robot applications
|
|
1 | 2024-10-09 | simulation |
A package which extends 'ros_base' and includes simulation packages.
A package which extends 'ros_base' and includes simulation packages.
|
|
2 | 2024-10-09 | ros_core |
A package to aggregate the packages required to use publish / subscribe, services, generate messages and other core ROS concepts.
A package to aggregate the packages required to use publish / subscribe, services, generate messages and other core ROS concepts.
|
|
2 | 2024-10-09 | ros_base |
A package which extends 'ros_core' and includes other basic functionalities like tf2 and urdf.
A package which extends 'ros_core' and includes other basic functionalities like tf2 and urdf.
|
|
2 | 2024-10-09 | perception |
A package which aggregates common perception packages.
A package which aggregates common perception packages.
|
|
1 | 2024-10-09 | mrpt_msgs |
ROS messages for MRPT classes and objects
ROS messages for MRPT classes and objects
|
|
2 | 2024-10-09 | desktop_full |
Provides a 'batteries included' experience to novice users.
Provides a 'batteries included' experience to novice users.
|
|
2 | 2024-10-09 | desktop |
A package which extends 'ros_base' and includes high level packages like vizualization tools and demos.
A package which extends 'ros_base' and includes high level packages like vizualization tools and demos.
|
|
1 | 2024-10-07 | urdf_launch |
Launch files for common URDF operations
Launch files for common URDF operations
|
|
1 | 2024-10-07 | rsl |
ROS Support Library
ROS Support Library
|
|
1 | 2024-10-02 | rqt_dotgraph |
rqt GUI plugin to visualize dot graphs.
rqt GUI plugin to visualize dot graphs.
|
|
1 | 2024-10-01 | rviz_imu_plugin |
RVIZ plugin for IMU visualization
RVIZ plugin for IMU visualization
|
|
1 | 2024-10-01 | imu_tools |
Various tools for IMU devices
Various tools for IMU devices
|
|
1 | 2024-10-01 | imu_filter_madgwick |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
|
|
1 | 2024-10-01 | imu_complementary_filter |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into a quaternion to represent the orientation of the device wrt the global frame. Based on the algorithm by Roberto G. Valenti etal. described in the paper "Keeping a Good Attitude: A Quaternion-Based Orientation Filter for IMUs and MARGs" available at http://www.mdpi.com/1424-8220/15/8/19302 .
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into a quaternion to represent the orientation of the device wrt the global frame. Based on the algorithm by Roberto G. Valenti etal. described in the paper "Keeping a Good Attitude: A Quaternion-Based Orientation Filter for IMUs and MARGs" available at http://www.mdpi.com/1424-8220/15/8/19302 .
|
|
1 | 2024-09-30 | gz_transport_vendor |
Vendor package for: gz-transport14 14.0.0
Gazebo Transport: Provides fast and efficient asynchronous message passing, services, and data logging.
Vendor package for: gz-transport14 14.0.0
Gazebo Transport: Provides fast and efficient asynchronous message passing, services, and data logging.
|
|
1 | 2024-09-30 | gz_sim_vendor |
Vendor package for: gz-sim9 9.0.0
Gazebo Sim : A Robotic Simulator
Vendor package for: gz-sim9 9.0.0
Gazebo Sim : A Robotic Simulator
|
|
1 | 2024-09-30 | gz_sensors_vendor |
Vendor package for: gz-sensors9 9.0.0
Gazebo Sensors : Sensor models for simulation
Vendor package for: gz-sensors9 9.0.0
Gazebo Sensors : Sensor models for simulation
|
|
1 | 2024-09-30 | gz_rendering_vendor |
Vendor package for: gz-rendering9 9.0.0
Gazebo Rendering: Rendering library for robot applications
Vendor package for: gz-rendering9 9.0.0
Gazebo Rendering: Rendering library for robot applications
|
|
1 | 2024-09-30 | gz_plugin_vendor |
Vendor package for: gz-plugin3 3.0.0
Gazebo Plugin : Cross-platform C++ library for dynamically loading plugins.
Vendor package for: gz-plugin3 3.0.0
Gazebo Plugin : Cross-platform C++ library for dynamically loading plugins.
|
|
1 | 2024-09-30 | gz_physics_vendor |
Vendor package for: gz-physics8 8.0.0
Gazebo Physics : Physics classes and functions for robot applications
Vendor package for: gz-physics8 8.0.0
Gazebo Physics : Physics classes and functions for robot applications
|
|
1 | 2024-09-30 | gz_launch_vendor |
Vendor package for: gz-launch8 8.0.0
Gazebo Launch : Run and manage programs and plugins
Vendor package for: gz-launch8 8.0.0
Gazebo Launch : Run and manage programs and plugins
|
|
1 | 2024-09-30 | gz_gui_vendor |
Vendor package for: gz-gui9 9.0.0
Gazebo GUI : Graphical interfaces for robotics applications
Vendor package for: gz-gui9 9.0.0
Gazebo GUI : Graphical interfaces for robotics applications
|
|
1 | 2024-09-30 | gz_fuel_tools_vendor |
Vendor package for: gz-fuel_tools10 10.0.0
Gazebo Fuel Tools: Classes and tools for interacting with Gazebo Fuel
Vendor package for: gz-fuel_tools10 10.0.0
Gazebo Fuel Tools: Classes and tools for interacting with Gazebo Fuel
|
|
1 | 2024-09-28 | boost_plugin_loader |
Boost plugin loader implementation
Boost plugin loader implementation
|
|
1 | 2024-09-27 | grasping_msgs |
Messages for describing objects and how to grasp them.
Messages for describing objects and how to grasp them.
|
|
1 | 2024-09-24 | sick_safetyscanners2 |
ROS2 Driver for the SICK safetyscanners
ROS2 Driver for the SICK safetyscanners
|
|
1 | 2024-09-24 | performance_test_ros1_publisher |
A ROS1 publisher to use with performance_test
A ROS1 publisher to use with performance_test
|
|
1 | 2024-09-24 | performance_test_ros1_msgs |
ROS1 versions of performance_test messages to use when testing with a ROS1 bridge
ROS1 versions of performance_test messages to use when testing with a ROS1 bridge
|
|
1 | 2024-09-24 | performance_test |
Tool to test performance of ROS2 and DDS data layers and communication.
Tool to test performance of ROS2 and DDS data layers and communication.
|
|
1 | 2024-09-24 | performance_report |
Apex.AI performance_test runner, plotter, and reporter
Apex.AI performance_test runner, plotter, and reporter
|
|
1 | 2024-09-23 | smach_ros |
The smach_ros package contains extensions for the SMACH library to
integrate it tightly with ROS. For example, SMACH-ROS can call
ROS services, listen to ROS topics, and integrate
with
The smach_ros package contains extensions for the SMACH library to
integrate it tightly with ROS. For example, SMACH-ROS can call
ROS services, listen to ROS topics, and integrate
with
|
|
1 | 2024-09-23 | smach_msgs |
this package contains a set of messages that are used by the introspection
interfaces for smach.
this package contains a set of messages that are used by the introspection
interfaces for smach.
|
|
1 | 2024-09-23 | smach |
SMACH is a task-level architecture for rapidly creating complex robot
behavior. At its core, SMACH is a ROS-independent Python library to build
hierarchical state machines. SMACH is a new library that takes advantage of
very old concepts in order to quickly create robust robot behavior with
maintainable and modular code.
SMACH is a task-level architecture for rapidly creating complex robot
behavior. At its core, SMACH is a ROS-independent Python library to build
hierarchical state machines. SMACH is a new library that takes advantage of
very old concepts in order to quickly create robust robot behavior with
maintainable and modular code.
|
|
1 | 2024-09-23 | executive_smach |
This metapackage depends on the SMACH library and ROS SMACH integration
packages.
This metapackage depends on the SMACH library and ROS SMACH integration
packages.
|
|
1 | 2024-09-20 | mrt_cmake_modules |
CMake Functions and Modules for automating CMake
CMake Functions and Modules for automating CMake
|
|
1 | 2024-09-16 | sdformat_urdf |
URDF plugin to parse SDFormat XML into URDF C++ DOM objects.
URDF plugin to parse SDFormat XML into URDF C++ DOM objects.
|
|
1 | 2024-09-16 | sdformat_test_files |
Example SDFormat XML files for testing tools using hthis format.
Example SDFormat XML files for testing tools using hthis format.
|
|
1 | 2024-09-13 | trac_ik_python |
The trac_ik_python package contains a python wrapper using SWIG
for trac_ik_lib
The trac_ik_python package contains a python wrapper using SWIG
for trac_ik_lib
|
|
1 | 2024-09-13 | trac_ik_lib |
TRAC-IK is a faster, significantly more reliable drop-in replacement for
KDL's pseudoinverse Jacobian solver.
The TRAC-IK library has a very similar API to KDL's IK solver calls,
except that the user passes a maximum time instead of a maximum number of
search iterations. Additionally, TRAC-IK allows for error tolerances to
be set independently for each Cartesian dimension (x,y,z,roll,pitch.yaw).
TRAC-IK is a faster, significantly more reliable drop-in replacement for
KDL's pseudoinverse Jacobian solver.
The TRAC-IK library has a very similar API to KDL's IK solver calls,
except that the user passes a maximum time instead of a maximum number of
search iterations. Additionally, TRAC-IK allows for error tolerances to
be set independently for each Cartesian dimension (x,y,z,roll,pitch.yaw).
|
|
1 | 2024-09-13 | trac_ik_kinematics_plugin |
A MoveIt! Kinematics plugin using TRAC-IK
A MoveIt! Kinematics plugin using TRAC-IK
|
|
1 | 2024-09-13 | trac_ik_examples |
This package contains the source code for testing and comparing trac_ik
This package contains the source code for testing and comparing trac_ik
|
|
1 | 2024-09-13 | trac_ik |
The ROS packages in this repository were created to provide an improved
alternative Inverse Kinematics solver to the popular inverse Jacobian
methods in KDL. TRAC-IK handles joint-limited chains better than KDL
without increasing solve time.
The ROS packages in this repository were created to provide an improved
alternative Inverse Kinematics solver to the popular inverse Jacobian
methods in KDL. TRAC-IK handles joint-limited chains better than KDL
without increasing solve time.
|
|
1 | 2024-09-11 | urdfdom |
A library to access URDFs using the DOM model.
A library to access URDFs using the DOM model.
|
|
1 | 2024-09-11 | polygon_utils |
Utilities for working with polygons, including triangulation
Utilities for working with polygons, including triangulation
|
|
1 | 2024-09-11 | polygon_rviz_plugins |
RViz visualizations for polygons
RViz visualizations for polygons
|
|
1 | 2024-09-11 | polygon_msgs |
General purpose two-dimensional polygons. Formerly a part of nav_2d_msgs
General purpose two-dimensional polygons. Formerly a part of nav_2d_msgs
|
|
1 | 2024-09-11 | polygon_demos |
Demo of polygon_rviz_plugins
Demo of polygon_rviz_plugins
|
|
1 | 2024-09-11 | 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 | 2024-09-09 | nmea_navsat_driver |
Package to parse NMEA strings and publish a very simple GPS message. Does not
require or use the GPSD deamon.
Package to parse NMEA strings and publish a very simple GPS message. Does not
require or use the GPSD deamon.
|
|
2 | 2024-09-06 | teleop_twist_joy |
Generic joystick teleop for twist robots.
Generic joystick teleop for twist robots.
|
|
1 | 2024-09-05 | motion_capture_tracking_interfaces |
Interfaces for motion_capture_tracking package.
Interfaces for motion_capture_tracking package.
|
|
1 | 2024-09-05 | motion_capture_tracking |
ROS Package for different motion capture systems, including custom rigid body tracking support
ROS Package for different motion capture systems, including custom rigid body tracking support
|
|
1 | 2024-09-05 | gz_ogre_next_vendor |
Vendor package for Ogre-next v2.3.3
Vendor package for Ogre-next v2.3.3
|
|
2 | 2024-09-05 | ament_cmake_black |
The CMake API for ament_black to lint Python code using black.
The CMake API for ament_black to lint Python code using black.
|
|
2 | 2024-09-05 | ament_black |
The ability to check code against style conventions using
black and generate xUnit test result files.
The ability to check code against style conventions using
black and generate xUnit test result files.
|
|
1 | 2024-09-04 | rviz_visual_tools |
Utility functions for displaying and debugging data in Rviz via published markers
Utility functions for displaying and debugging data in Rviz via published markers
|
|
1 | 2024-09-01 | mrpt_sensors |
ROS nodes for various robotics sensors via mrpt-hwdrivers. Metapackage for all mrpt_sensor packages.
ROS nodes for various robotics sensors via mrpt-hwdrivers. Metapackage for all mrpt_sensor packages.
|
|
1 | 2024-09-01 | mrpt_sensorlib |
C++ library for the base generic MRPT sensor node
C++ library for the base generic MRPT sensor node
|
|
1 | 2024-09-01 | mrpt_sensor_imu_taobotics |
ROS node for Taobotics USB IMUs (based on mrpt-hwdrivers)
ROS node for Taobotics USB IMUs (based on mrpt-hwdrivers)
|
|
1 | 2024-09-01 | mrpt_sensor_gnss_novatel |
ROS node for GNSS/IMU Novatel receivers with RTK precision using an NTRIP HTTP source (based on mrpt-hwdrivers)
ROS node for GNSS/IMU Novatel receivers with RTK precision using an NTRIP HTTP source (based on mrpt-hwdrivers)
|
|
1 | 2024-09-01 | mrpt_sensor_gnss_nmea |
ROS node for GNSS receivers generating NMEA messages (based on mrpt-hwdrivers)
ROS node for GNSS receivers generating NMEA messages (based on mrpt-hwdrivers)
|
|
1 | 2024-09-01 | mrpt_sensor_bumblebee_stereo |
ROS node for Bumblebee Stereo Cameras using libdc1394 interface (based on mrpt-hwdrivers)
ROS node for Bumblebee Stereo Cameras using libdc1394 interface (based on mrpt-hwdrivers)
|
|
1 | 2024-09-01 | mrpt_generic_sensor |
ROS node for interfacing any sensor supported by mrpt-hwdrivers
ROS node for interfacing any sensor supported by mrpt-hwdrivers
|
|
1 | 2024-08-31 | py_trees_ros |
ROS2 extensions and behaviours for py_trees.
ROS2 extensions and behaviours for py_trees.
|
|
1 | 2024-08-30 | ffmpeg_encoder_decoder |
ROS2 convenience wrapper around ffmpeg for encoding/decoding
ROS2 convenience wrapper around ffmpeg for encoding/decoding
|
|
1 | 2024-08-29 | warehouse_ros |
Persistent storage of ROS messages
Persistent storage of ROS messages
|
|
1 | 2024-08-29 | rosx_introspection |
Successor of ros_type_introspection
Successor of ros_type_introspection
|
|
1 | 2024-08-20 | sick_safetyscanners_base |
Provides an Interface to read the sensor output of a SICK
Safety Scanner
Provides an Interface to read the sensor output of a SICK
Safety Scanner
|
|
1 | 2024-08-20 | 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 | 2024-08-19 | mola_common |
Common CMake scripts to all MOLA modules
Common CMake scripts to all MOLA modules
|
|
1 | 2024-08-14 | battery_state_rviz_overlay |
Converts BatteryState messages to RViz OverlayText messages.
Converts BatteryState messages to RViz OverlayText messages.
|
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2024-06-17 | librealsense2 |
Library for controlling and capturing data from the Intel(R) RealSense(TM) D400 devices.
Library for controlling and capturing data from the Intel(R) RealSense(TM) D400 devices.
|
|
2 | 2024-06-15 | reach_ros |
The reach_ros package
The reach_ros package
|
|
1 | 2024-06-12 | vl53l1x |
VL53L1X ToF rangefinder driver
VL53L1X ToF rangefinder driver
|
|
1 | 2024-06-12 | dynamic-graph |
Dynamic graph library
Dynamic graph library
|
|
1 | 2024-06-08 | ortools_vendor |
Wrapper around ortools, it provides a fixed CMake module and an ExternalProject build of it.
Wrapper around ortools, it provides a fixed CMake module and an ExternalProject build of it.
|
|
1 | 2024-06-07 | fetch_teleop |
Teleoperation for fetch and freight.
Teleoperation for fetch and freight.
|
|
1 | 2024-06-07 | fetch_ros |
Fetch ROS, packages for working with Fetch and Freight
Fetch ROS, packages for working with Fetch and Freight
|
|
1 | 2024-06-07 | fetch_navigation |
Configuration and launch files for running ROS navigation on Fetch.
Configuration and launch files for running ROS navigation on Fetch.
|
|
1 | 2024-06-07 | fetch_moveit_config |
An automatically generated package with all the configuration and launch files for using the fetch_urdf with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the fetch_urdf with the MoveIt Motion Planning Framework
|
|
1 | 2024-06-07 | fetch_maps |
The fetch_maps package
The fetch_maps package
|
|
1 | 2024-06-07 | fetch_ikfast_plugin |
Kinematics plugin for Fetch robot, generated through IKFast
Kinematics plugin for Fetch robot, generated through IKFast
|
|
1 | 2024-06-07 | fetch_description |
URDF for Fetch Robot.
URDF for Fetch Robot.
|
|
1 | 2024-06-07 | fetch_depth_layer |
The fetch_depth_layer package
The fetch_depth_layer package
|
|
1 | 2024-06-07 | fetch_calibration |
Launch and configuration files for calibrating Fetch using the 'robot_calibration' package.
Launch and configuration files for calibrating Fetch using the 'robot_calibration' package.
|
|
1 | 2024-06-06 | message_tf_frame_transformer |
Transforms messages of arbitrary type to a different frame using tf2::doTransform
Transforms messages of arbitrary type to a different frame using tf2::doTransform
|
|
1 | 2024-06-06 | hebi_cpp_api |
A ROS package providing access to the HEBI C++ API.
A ROS package providing access to the HEBI C++ API.
|
|
2 | 2024-06-04 | aruco_opencv_msgs |
Message definitions for aruco_opencv package.
Message definitions for aruco_opencv package.
|
|
2 | 2024-06-04 | aruco_opencv |
ArUco marker detection using aruco module from OpenCV libraries.
ArUco marker detection using aruco module from OpenCV libraries.
|
|
1 | 2024-06-03 | swri_yaml_util |
Provides wrappers around the yaml-cpp library for various utility functions
and to abstract out the API changes made to yaml-cpp between ubuntu:precise
and ubuntu:trusty.
Provides wrappers around the yaml-cpp library for various utility functions
and to abstract out the API changes made to yaml-cpp between ubuntu:precise
and ubuntu:trusty.
|
|
1 | 2024-06-03 | swri_transform_util |
The swri_transform_util package contains utility functions and classes for
transforming between coordinate frames.
The swri_transform_util package contains utility functions and classes for
transforming between coordinate frames.
|
|
1 | 2024-06-03 | swri_system_util |
swri_system_util
swri_system_util
|
|
1 | 2024-06-03 | swri_string_util |
swri_string_util
swri_string_util
|
|
1 | 2024-06-03 | swri_serial_util |
swri_serial_util
swri_serial_util
|
|
1 | 2024-06-03 | swri_route_util |
This library provides functionality to simplify working with the
navigation messages defined in marti_nav_msgs.
This library provides functionality to simplify working with the
navigation messages defined in marti_nav_msgs.
|
|
1 | 2024-06-03 | swri_rospy |
This package provides added functionality on top of rospy, including a
single-threaded callback queue.
This package provides added functionality on top of rospy, including a
single-threaded callback queue.
|
|
1 | 2024-06-03 | swri_roscpp |
Enhancements to roscpp functionality to reduce boilerplate code and implement common patterns.
Enhancements to roscpp functionality to reduce boilerplate code and implement common patterns.
|
|
1 | 2024-06-03 | swri_prefix_tools |
Contains scripts that are useful as prefix commands for nodes
started by roslaunch.
Contains scripts that are useful as prefix commands for nodes
started by roslaunch.
|
|
1 | 2024-06-03 | swri_opencv_util |
swri_opencv_util
swri_opencv_util
|
|
1 | 2024-06-03 | swri_nodelet |
This package provides a simple script to write simple launch files
that can easily switch between running nodelets together or as
standalone nodes.
This package provides a simple script to write simple launch files
that can easily switch between running nodelets together or as
standalone nodes.
|
|
1 | 2024-06-03 | swri_math_util |
swri_math_util
swri_math_util
|
|
1 | 2024-06-03 | swri_image_util |
swri_image_util
swri_image_util
|
|
1 | 2024-06-03 | swri_geometry_util |
swri_geometry_util
swri_geometry_util
|
|
1 | 2024-06-03 | swri_dbw_interface |
This package provides documentation on common interface conventions for
drive-by-wire systems.
This package provides documentation on common interface conventions for
drive-by-wire systems.
|
|
1 | 2024-06-03 | swri_console_util |
swri_console_util
swri_console_util
|
|
1 | 2024-06-03 | swri_cli_tools |
rosman contains the rosman tool for introspecting ROS nodes
rosman contains the rosman tool for introspecting ROS nodes
|
|
1 | 2024-06-03 | marti_data_structures |
marti_data_structures
marti_data_structures
|
|
1 | 2024-05-30 | opw_kinematics |
A simple, analytical inverse kinematic library for industrial robots with parallel bases and
spherical wrists. Based on the paper "An Analytical Solution of the Inverse Kinematics Problem
of Industrial Serial Manipulators with an Ortho-parallel Basis and a Spherical Wrist" by
Mathias Brandstötter, Arthur Angerer, and Michael Hofbaur.
A simple, analytical inverse kinematic library for industrial robots with parallel bases and
spherical wrists. Based on the paper "An Analytical Solution of the Inverse Kinematics Problem
of Industrial Serial Manipulators with an Ortho-parallel Basis and a Spherical Wrist" by
Mathias Brandstötter, Arthur Angerer, and Michael Hofbaur.
|
|
1 | 2024-05-27 | libnabo |
libnabo is a fast K Nearest Neighbour library for low-dimensional spaces.
libnabo is a fast K Nearest Neighbour library for low-dimensional spaces.
|
|
1 | 2024-05-27 | exotica_time_indexed_rrt_connect_solver |
Time-Indexed RRT-Connect solver (Humanoids 2018)
Time-Indexed RRT-Connect solver (Humanoids 2018)
|
|
1 | 2024-05-27 | exotica_scipy_solver |
SciPy-based Python solvers for Exotica
SciPy-based Python solvers for Exotica
|
|
1 | 2024-05-27 | exotica_quadrotor_dynamics_solver |
Quadrotor dynamics solver plug-in for Exotica
Quadrotor dynamics solver plug-in for Exotica
|
|
1 | 2024-05-27 | exotica_python |
Python bindings for EXOTica
Python bindings for EXOTica
|
|
1 | 2024-05-27 | exotica_pinocchio_dynamics_solver |
Dynamics solver plug-in using Pinocchio for Exotica
Dynamics solver plug-in using Pinocchio for Exotica
|
|
1 | 2024-05-27 | exotica_pendulum_dynamics_solver |
Pendulum dynamics solver plug-in for Exotica
Pendulum dynamics solver plug-in for Exotica
|
|
1 | 2024-05-27 | exotica_ompl_solver |
Exotica solvers based on the Open Motion Planning Libary (OMPL)
Exotica solvers based on the Open Motion Planning Libary (OMPL)
|
|
1 | 2024-05-27 | exotica_ompl_control_solver |
Kinodynamic Control Solvers from OMPL
Kinodynamic Control Solvers from OMPL
|
|
1 | 2024-05-27 | exotica_levenberg_marquardt_solver |
A Levenberg-Marquardt solver for EXOTica
A Levenberg-Marquardt solver for EXOTica
|
|
1 | 2024-05-27 | exotica_ilqr_solver |
ILQR Solver (Li and Todorov, 2004)
ILQR Solver (Li and Todorov, 2004)
|
|
1 | 2024-05-27 | exotica_ilqg_solver |
ILQG Solver (Todorov and Li, 2004)
ILQG Solver (Todorov and Li, 2004)
|
|
1 | 2024-05-27 | exotica_ik_solver |
Regularised and weighted pseudo-inverse unconstrained end-pose solver
Regularised and weighted pseudo-inverse unconstrained end-pose solver
|
|
1 | 2024-05-27 | exotica_examples |
Package containing examples and system tests for EXOTica.
Package containing examples and system tests for EXOTica.
|
|
1 | 2024-05-27 | exotica_dynamics_solvers |
Metapackage for all dynamics solvers bundled with core EXOTica.
Metapackage for all dynamics solvers bundled with core EXOTica.
|
|
1 | 2024-05-27 | exotica_double_integrator_dynamics_solver |
Double integrator dynamics solver plug-in for Exotica
Double integrator dynamics solver plug-in for Exotica
|
|
1 | 2024-05-27 | exotica_ddp_solver |
Various DDP Solvers
Various DDP Solvers
|
|
1 | 2024-05-27 | exotica_core_task_maps |
Common taskmaps provided with EXOTica.
Common taskmaps provided with EXOTica.
|
|
1 | 2024-05-27 | exotica_core |
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning.
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning.
|
|
1 | 2024-05-27 | exotica_collision_scene_fcl_latest |
Collision checking and distance computation using the latest version of the FCL library.
Collision checking and distance computation using the latest version of the FCL library.
|
|
1 | 2024-05-27 | exotica_cartpole_dynamics_solver |
Cartpole dynamics solver plug-in for Exotica
Cartpole dynamics solver plug-in for Exotica
|
|
1 | 2024-05-27 | exotica_aico_solver |
Implementation of the Approximate Inference Control algorithm (AICO)
Implementation of the Approximate Inference Control algorithm (AICO)
|
|
1 | 2024-05-27 | exotica |
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning. This package serves similar to a metapackage and contains dependencies onto all core-released exotica packages. It also builds the documentation.
The Extensible Optimization Toolset (EXOTica) is a library for defining problems for robot motion planning. This package serves similar to a metapackage and contains dependencies onto all core-released exotica packages. It also builds the documentation.
|
|
1 | 2024-05-25 | steering_functions |
The steering_functions package
The steering_functions package
|
|
1 | 2024-05-24 | jackal_tutorials |
Jackal's tutorials.
Jackal's tutorials.
|
|
1 | 2024-05-24 | jackal_navigation |
Launch files and code for autonomous navigation of the Jackal
Launch files and code for autonomous navigation of the Jackal
|
|
1 | 2024-05-24 | jackal_msgs |
Messages exclusive to Jackal, especially for representing low-level motor commands and sensors.
Messages exclusive to Jackal, especially for representing low-level motor commands and sensors.
|
|
1 | 2024-05-24 | jackal_description |
URDF robot description for Jackal
URDF robot description for Jackal
|
|
1 | 2024-05-24 | jackal_control |
Controllers for Jackal
Controllers for Jackal
|
|
1 | 2024-05-23 | trajectory_tracker_rviz_plugins |
Rviz plugins for trajectory_tracker_msgs
Rviz plugins for trajectory_tracker_msgs
|
|
1 | 2024-05-23 | neonavigation_rviz_plugins |
Rviz plugins for neonavigation package
Rviz plugins for neonavigation package
|
|
1 | 2024-05-23 | costmap_cspace_rviz_plugins |
Rviz plugins for costmap_cspace_msgs
Rviz plugins for costmap_cspace_msgs
|
|
2 | 2024-05-22 | velocity_controllers |
velocity_controllers
velocity_controllers
|
|
2 | 2024-05-22 | rqt_joint_trajectory_controller |
Graphical frontend for interacting with joint_trajectory_controller instances.
Graphical frontend for interacting with joint_trajectory_controller instances.
|
|
1 | 2024-05-22 | ros_controllers |
Library of ros controllers
Library of ros controllers
|
|
2 | 2024-05-22 | position_controllers |
position_controllers
position_controllers
|
|
3 | 2024-05-22 | 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 | 2024-05-22 | joint_state_controller |
Controller to publish joint state
Controller to publish joint state
|
|
1 | 2024-05-22 | imu_sensor_controller |
Controller to publish state of IMU sensors
Controller to publish state of IMU sensors
|
|
1 | 2024-05-22 | gripper_action_controller |
The gripper_action_controller package
The gripper_action_controller package
|
|
1 | 2024-05-22 | four_wheel_steering_controller |
Controller for a four wheel steering mobile base.
Controller for a four wheel steering mobile base.
|
|
2 | 2024-05-22 | forward_command_controller |
forward_command_controller
forward_command_controller
|
|
1 | 2024-05-22 | force_torque_sensor_controller |
Controller to publish state of force-torque sensors
Controller to publish state of force-torque sensors
|
|
2 | 2024-05-22 | effort_controllers |
effort_controllers
effort_controllers
|
|
2 | 2024-05-22 | diff_drive_controller |
Controller for a differential drive mobile base.
Controller for a differential drive mobile base.
|
|
2 | 2024-05-22 | ackermann_steering_controller |
Controller for a steer drive mobile base.
Controller for a steer drive mobile base.
|
|
1 | 2024-05-21 | robot_controllers_msgs |
Messages for use with robot_controllers framework.
Messages for use with robot_controllers framework.
|
|
1 | 2024-05-21 | robot_controllers_interface |
Generic framework for robot controls.
Generic framework for robot controls.
|
|
1 | 2024-05-21 | robot_controllers |
Some basic robot controllers for use with robot_controllers_interface.
Some basic robot controllers for use with robot_controllers_interface.
|
|
2 | 2024-05-20 | rplidar_ros |
The rplidar ros package, support rplidar A1/A2/A3/S1/S2/S3/T1/C1
The rplidar ros package, support rplidar A1/A2/A3/S1/S2/S3/T1/C1
|
|
1 | 2024-05-15 | gpsd_client |
connects to a GPSd server and broadcasts GPS fixes
using the NavSatFix message
connects to a GPSd server and broadcasts GPS fixes
using the NavSatFix message
|
|
1 | 2024-05-15 | gps_umd |
gps_umd metapackage
gps_umd metapackage
|
|
1 | 2024-05-15 | gps_common |
GPS messages and common routines for use in GPS drivers
GPS messages and common routines for use in GPS drivers
|
|
1 | 2024-05-09 | plotjuggler_ros |
PlotJuggler plugin for ROS
PlotJuggler plugin for ROS
|
|
1 | 2024-05-07 | flatland_viz |
The flatland gui and visualization
The flatland gui and visualization
|
|
1 | 2024-05-07 | flatland_server |
The flatland_server package
The flatland_server package
|
|
1 | 2024-05-07 | flatland_plugins |
Default plugins for flatland
Default plugins for flatland
|
|
1 | 2024-05-07 | flatland_msgs |
The flatland_msgs package
The flatland_msgs package
|
|
1 | 2024-05-07 | flatland |
This is the metapackage for flatland.
This is the metapackage for flatland.
|
|
1 | 2024-05-06 | grepros |
grep for ROS bag files and live topics: read, filter, export
grep for ROS bag files and live topics: read, filter, export
|
|
2 | 2024-05-03 | pyhri |
A Python wrapper library around the ROS4HRI ROS topics
A Python wrapper library around the ROS4HRI ROS topics
|
|
1 | 2024-05-02 | socketcan_interface |
Generic CAN interface description with helpers for filtering and driver implementation. Further a socketcan implementation based on boost::asio is included.
Generic CAN interface description with helpers for filtering and driver implementation. Further a socketcan implementation based on boost::asio is included.
|
|
1 | 2024-05-02 | socketcan_bridge |
Conversion nodes for messages from SocketCAN to a ROS Topic and vice versa.
Conversion nodes for messages from SocketCAN to a ROS Topic and vice versa.
|
|
1 | 2024-05-02 | ros_canopen |
A generic canopen implementation for ROS
A generic canopen implementation for ROS
|
|
1 | 2024-05-02 | canopen_motor_node |
canopen_chain_node specialization for handling of canopen_402 motor devices. It facilitates interface abstraction with ros_control.
canopen_chain_node specialization for handling of canopen_402 motor devices. It facilitates interface abstraction with ros_control.
|
|
1 | 2024-05-02 | canopen_master |
CiA(r) CANopen 301 master implementation with support for interprocess master synchronisation.
CiA(r) CANopen 301 master implementation with support for interprocess master synchronisation.
|
|
1 | 2024-05-02 | canopen_chain_node |
Base implementation for CANopen chains node with support for management services and diagnostics
Base implementation for CANopen chains node with support for management services and diagnostics
|
|
1 | 2024-05-02 | canopen_402 |
This implements the CANopen device profile for drives and motion control. CiA(r) 402
This implements the CANopen device profile for drives and motion control. CiA(r) 402
|
|
1 | 2024-05-02 | can_msgs |
CAN related message types.
CAN related message types.
|
|
1 | 2024-05-01 | ypspur |
YP-Spur is a mobile robot motion control software with coordinate frame based commands.
YP-Spur is a mobile robot motion control software with coordinate frame based commands.
|
|
1 | 2024-04-30 | warthog_msgs |
Messages exclusive to Warthog, especially for representing low-level motor commands and sensors.
Messages exclusive to Warthog, especially for representing low-level motor commands and sensors.
|
|
1 | 2024-04-30 | warthog_description |
URDF robot description for Warthog
URDF robot description for Warthog
|
|
1 | 2024-04-30 | warthog_control |
Controllers for Warthog
Controllers for Warthog
|
|
2 | 2024-04-30 | service_tools |
Service tools
Service tools
|
|
2 | 2024-04-30 | scenario_test_tools |
The scenario_test_tools package implements helpers for scriptable scenario testing.
It allows to set up a test harness for eg. a state machine or other high level behavior by
providing mocked implementations for various action servers and services that work together
The scenario_test_tools package implements helpers for scriptable scenario testing.
It allows to set up a test harness for eg. a state machine or other high level behavior by
providing mocked implementations for various action servers and services that work together
|
|
2 | 2024-04-30 | raw_description |
This package contains the description (mechanical, kinematic, visual,
etc.) of the Care-O-bot robot. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
This package contains the description (mechanical, kinematic, visual,
etc.) of the Care-O-bot robot. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
|
|
2 | 2024-04-30 | laser_scan_densifier |
The laser_scan_densifier takes in a LaserScan message and densifies it.
Node is inspired by laser_scan_sparsifier (http://wiki.ros.org/laser_scan_sparsifier).
The laser_scan_densifier takes in a LaserScan message and densifies it.
Node is inspired by laser_scan_sparsifier (http://wiki.ros.org/laser_scan_sparsifier).
|
|
2 | 2024-04-30 | generic_throttle |
This package provides a throttle for ROS topics
This package provides a throttle for ROS topics
|
|
2 | 2024-04-30 | cob_voltage_control |
Interface to IO board that manages emergency stop and battery voltage on rob@work 3
Interface to IO board that manages emergency stop and battery voltage on rob@work 3
|
|
2 | 2024-04-30 | cob_utilities |
Deprecated
"cob_utilities" subsumes a number of classes, which are used in the original COb3 software. E.g. "IniFile.h" supports the original inifile structure of Care-O-bot 3. "MathSup.h" provides some basic functions like conversion from degree to radion or norming of angles within +/- PI. The package is currently used while the drivers are ported to ROS and Orocos respectively. Midterm it shall be removed and the ROS structures shall be used for reading parameters during initialization. So, don't use this package in new code!
Deprecated
"cob_utilities" subsumes a number of classes, which are used in the original COb3 software. E.g. "IniFile.h" supports the original inifile structure of Care-O-bot 3. "MathSup.h" provides some basic functions like conversion from degree to radion or norming of angles within +/- PI. The package is currently used while the drivers are ported to ROS and Orocos respectively. Midterm it shall be removed and the ROS structures shall be used for reading parameters during initialization. So, don't use this package in new code!
|
|
2 | 2024-04-30 | cob_undercarriage_ctrl |
cob_undercarriage_ctrl implements a controller for the omnidirectional base of Care-O-bot 3 on joint level. For a given Pltf-Twist the according wheel steering angles and linear wheel velocities are calculated based on the principle of rigid body motion. Each joint is than controlled individually to achieve the computed position and velocity
cob_undercarriage_ctrl implements a controller for the omnidirectional base of Care-O-bot 3 on joint level. For a given Pltf-Twist the according wheel steering angles and linear wheel velocities are calculated based on the principle of rigid body motion. Each joint is than controlled individually to achieve the computed position and velocity
|
|
2 | 2024-04-30 | cob_twist_controller |
The main purpose of the cob_twist_controller is to convert target twists into joint velocities.
Therefore it makes use of several implemented inverse kinematics approaches at the first order differential level.
The inverse differential kinematics solver considers kinematic chain extensions, singularity robustness,
redundancy resolution and priority-based methods.
To avoid hardware destruction there is a limiter interface active as well.
Via parameter server users can dynamically configure the solving strategy.
The main purpose of the cob_twist_controller is to convert target twists into joint velocities.
Therefore it makes use of several implemented inverse kinematics approaches at the first order differential level.
The inverse differential kinematics solver considers kinematic chain extensions, singularity robustness,
redundancy resolution and priority-based methods.
To avoid hardware destruction there is a limiter interface active as well.
Via parameter server users can dynamically configure the solving strategy.
|
|
2 | 2024-04-30 | cob_tricycle_controller |
The cob_omni_drive_controller package provides a ros_controller plugin for the Care-O-bot tricycle base platform.
The cob_omni_drive_controller package provides a ros_controller plugin for the Care-O-bot tricycle base platform.
|
|
2 | 2024-04-30 | cob_trajectory_controller |
This package provides a trajectory controller which controlls velocities for a chain of joints. This controller can be used e.g. with [[schunk_powercube_chain]].
This package provides a trajectory controller which controlls velocities for a chain of joints. This controller can be used e.g. with [[schunk_powercube_chain]].
|
|
2 | 2024-04-30 | cob_teleop |
Teleop node
Teleop node
|
|
2 | 2024-04-30 | cob_srvs |
This Package contains Care-O-bot specific service definitions.
This Package contains Care-O-bot specific service definitions.
|
|
2 | 2024-04-30 | cob_sound |
This package implements a sound play module using text2wave and aplay through python.
This package implements a sound play module using text2wave and aplay through python.
|
|
2 | 2024-04-30 | cob_sick_s300 |
This package published a laser scan message out of a Sick S300 laser scanner.
This package published a laser scan message out of a Sick S300 laser scanner.
|
|
2 | 2024-04-30 | cob_sick_lms1xx |
This package published a laser scan message out of a Sick LMS1xx laser scanner.
This version is made by fusion of ipa320/RCPRG_laser_drivers and ipa320/libLMS1xx repository. This package shuld have clearer structure and be easier to install.
This package published a laser scan message out of a Sick LMS1xx laser scanner.
This version is made by fusion of ipa320/RCPRG_laser_drivers and ipa320/libLMS1xx repository. This package shuld have clearer structure and be easier to install.
|
|
2 | 2024-04-30 | cob_script_server |
The cob_script_server package provides a simple interface to operate Care-O-bot. It can be used via the python API or the actionlib interface.
The cob_script_server package provides a simple interface to operate Care-O-bot. It can be used via the python API or the actionlib interface.
|
|
2 | 2024-04-30 | cob_scan_unifier |
The cob_scan_unifier package holds code to unify two or more laser-scans to one unified scan-message
The cob_scan_unifier package holds code to unify two or more laser-scans to one unified scan-message
|
|
2 | 2024-04-30 | cob_relayboard |
cob_relayboard
cob_relayboard
|
|
2 | 2024-04-30 | cob_phidgets |
cob_phidgets
cob_phidgets
|
|
2 | 2024-04-30 | cob_phidget_power_state |
The cob_phidget_power_state package publishes power state based on phidgets signals.
The cob_phidget_power_state package publishes power state based on phidgets signals.
|
|
2 | 2024-04-30 | cob_phidget_em_state |
The cob_phidget_em_state package publishes emergency state based on phidgets signals.
The cob_phidget_em_state package publishes emergency state based on phidgets signals.
|
|
2 | 2024-04-30 | cob_omni_drive_controller |
The cob_omni_drive_controller package provides a ros_controller plugin for the Care-O-bot omni-directional base platform.
The cob_omni_drive_controller package provides a ros_controller plugin for the Care-O-bot omni-directional base platform.
|
|
2 | 2024-04-30 | cob_obstacle_distance |
The cob_obstacle_distance package calculates distances between both robot links and obstacles to be used for obstacle avoidance within cob_twist_controller framework.
The cob_obstacle_distance package calculates distances between both robot links and obstacles to be used for obstacle avoidance within cob_twist_controller framework.
|
|
2 | 2024-04-30 | cob_msgs |
Messages for representing state information, such as battery information and emergency stop status.
Messages for representing state information, such as battery information and emergency stop status.
|
|
2 | 2024-04-30 | cob_monitoring |
cob_monitoring
cob_monitoring
|
|
2 | 2024-04-30 | cob_model_identifier |
The cob_model_identifier package provides nodes to analyse the system response behavior of actuators to optimally tune PID controllers to be used with cob_twist_controller framework.
The cob_model_identifier package provides nodes to analyse the system response behavior of actuators to optimally tune PID controllers to be used with cob_twist_controller framework.
|
|
2 | 2024-04-30 | cob_mimic |
This package implements the Care-O-bot mimic
This package implements the Care-O-bot mimic
|
|
2 | 2024-04-30 | cob_mecanum_controller |
The cob_mecanum_controller_node provides a lightweight base controller for mecanum drive robots.
The out/input for the wheel command/state are wheel velocities in rad/s for the wheels
[front left, front right, rear left, rear right]
The cob_mecanum_controller_node provides a lightweight base controller for mecanum drive robots.
The out/input for the wheel command/state are wheel velocities in rad/s for the wheels
[front left, front right, rear left, rear right]
|
|
2 | 2024-04-30 | cob_light |
This package contains scripts to operate the LED lights on Care-O-bot.
This package contains scripts to operate the LED lights on Care-O-bot.
|
|
2 | 2024-04-30 | cob_helper_tools |
Helper scripts for Care-O-bot
Helper scripts for Care-O-bot
|
|
2 | 2024-04-30 | cob_hardware_emulation |
The cob_hardware_emulation package provides idealized nodes emulating real robot hardware and/or physics simulation.
The cob_hardware_emulation package provides idealized nodes emulating real robot hardware and/or physics simulation.
|
|
2 | 2024-04-30 | cob_generic_can |
The package cob_generic_can provides an interface for nodes on a can-bus and examplary wrappers for two PeakSys-can-libs. When a can-bus-device is generated (for an example see base_dirve_chain) you can use generic_can to create as many itfs as there will be components communicating via this can-bus. Assign type of the can communication device (e.g. usb-to-can or can-card of a specific vendor) and can-address of the target device. This package comes with wrappers for PeakSys and PeakSysUSB adapters.
The package cob_generic_can provides an interface for nodes on a can-bus and examplary wrappers for two PeakSys-can-libs. When a can-bus-device is generated (for an example see base_dirve_chain) you can use generic_can to create as many itfs as there will be components communicating via this can-bus. Assign type of the can communication device (e.g. usb-to-can or can-card of a specific vendor) and can-address of the target device. This package comes with wrappers for PeakSys and PeakSysUSB adapters.
|
|
2 | 2024-04-30 | cob_frame_tracker |
The cob_frame_tracker package contains nodes that publish Twist commands based on the distance to the desired tf frame target.
The cob_frame_tracker package contains nodes that publish Twist commands based on the distance to the desired tf frame target.
|
|
2 | 2024-04-30 | cob_footprint_observer |
The cob_footprint_observer package adjusts the footprint of the robot based on the setup (e.g. arm and/or tray).
The cob_footprint_observer package adjusts the footprint of the robot based on the setup (e.g. arm and/or tray).
|
|
2 | 2024-04-30 | cob_elmo_homing |
This packagae implements the special homing procedure that is needed for old cob4/raw bases
This packagae implements the special homing procedure that is needed for old cob4/raw bases
|
|
2 | 2024-04-30 | cob_driver |
The cob_driver stack includes packages that provide access to the Care-O-bot hardware through ROS messages, services and actions. E.g. for mobile base, arm, camera sensors, laser scanners, etc...
The cob_driver stack includes packages that provide access to the Care-O-bot hardware through ROS messages, services and actions. E.g. for mobile base, arm, camera sensors, laser scanners, etc...
|
|
2 | 2024-04-30 | cob_description |
This package contains the description (mechanical, kinematic, visual,
etc.) of the Care-O-bot robot. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
This package contains the description (mechanical, kinematic, visual,
etc.) of the Care-O-bot robot. The files in this package are parsed and used by
a variety of other components. Most users will not interact directly
with this package.
|
|
2 | 2024-04-30 | cob_dashboard |
cob_dashboard is a modified version of [[pr2_dashboard]].
cob_dashboard is a modified version of [[pr2_dashboard]].
|
|
2 | 2024-04-30 | cob_control_msgs |
Common messages and services used in various packages within cob_control.
Common messages and services used in various packages within cob_control.
|
|
2 | 2024-04-30 | cob_control_mode_adapter |
The cob_control_mode_adapter package provides a node that automatically loads respective ros_controllers depending on required control mode.
The cob_control_mode_adapter package provides a node that automatically loads respective ros_controllers depending on required control mode.
|
|
2 | 2024-04-30 | cob_control |
cob_control meta-package
cob_control meta-package
|
|
2 | 2024-04-30 | cob_common |
The cob_common stack hosts common packages that are used within the Care-O-bot repository. E.g. utility packages or common message and service definitions etc. Also the urdf desciption of the robot is located in this stack.
The cob_common stack hosts common packages that are used within the Care-O-bot repository. E.g. utility packages or common message and service definitions etc. Also the urdf desciption of the robot is located in this stack.
|
|
2 | 2024-04-30 | cob_command_tools |
The cob_command_tools stack provides tools, for operating Care-O-bot.
The cob_command_tools stack provides tools, for operating Care-O-bot.
|
|
2 | 2024-04-30 | cob_command_gui |
This package provides a simple GUI for operating Care-O-bot.
This package provides a simple GUI for operating Care-O-bot.
|
|
2 | 2024-04-30 | cob_collision_velocity_filter |
The cob_collision_velocity_filter package is a package for collision avoidance using teleoperation.
The cob_collision_velocity_filter package is a package for collision avoidance using teleoperation.
|
|
2 | 2024-04-30 | cob_cartesian_controller |
This package provides nodes that broadcast tf-frames along various (model-based) Cartesian paths (e.g. Linear, Circular).
The tf-frames are interpolated using a given velocity profile (e.g. Ramp, Sinoid) and can be used as targets for the cob_frame_tracker/cob_twist_controller.
This package provides nodes that broadcast tf-frames along various (model-based) Cartesian paths (e.g. Linear, Circular).
The tf-frames are interpolated using a given velocity profile (e.g. Ramp, Sinoid) and can be used as targets for the cob_frame_tracker/cob_twist_controller.
|
|
2 | 2024-04-30 | cob_canopen_motor |
The package cob_canopen_motor implements a controller-drive component which is connected to a can-bus and works with a canopen-interface. "CanDriveItf" provides a - more or less - generic interface to the controller-drive components. "CanDrvie..." then implements a specific setup, e.g. an ELMO Harmonica Controller in case of the "CanDriveHarmonica".
The package cob_canopen_motor implements a controller-drive component which is connected to a can-bus and works with a canopen-interface. "CanDriveItf" provides a - more or less - generic interface to the controller-drive components. "CanDrvie..." then implements a specific setup, e.g. an ELMO Harmonica Controller in case of the "CanDriveHarmonica".
|
|
2 | 2024-04-30 | cob_bms_driver |
Driver package for interfacing the battery management system (BMS) on Care-O-bot.
Driver package for interfacing the battery management system (BMS) on Care-O-bot.
|
|
2 | 2024-04-30 | cob_base_velocity_smoother |
The 'cob_base_velocity_smoother' reads velocity messages and publishes messages of the same type for "smoothed" velocity to avoid shaking behavior.
The 'cob_base_velocity_smoother' reads velocity messages and publishes messages of the same type for "smoothed" velocity to avoid shaking behavior.
|
|
2 | 2024-04-30 | cob_base_drive_chain |
This package contains classes that are able to control the platform of the Care-O-Bot. This means to establish a CAN communication to drive and steering motors of the platform and later send motion commands and receive motor information.
This package contains classes that are able to control the platform of the Care-O-Bot. This means to establish a CAN communication to drive and steering motors of the platform and later send motion commands and receive motor information.
|
|
2 | 2024-04-30 | cob_base_controller_utils |
The cob_base_controller_utils package contains common utils for various base_controllers.
The cob_base_controller_utils package contains common utils for various base_controllers.
|
|
2 | 2024-04-30 | cob_actions |
This Package contains Care-O-bot specific action definitions.
This Package contains Care-O-bot specific action definitions.
|
|
1 | 2024-04-28 | ws281x |
ROS node for rpi_ws281x LED strip driver
ROS node for rpi_ws281x LED strip driver
|
|
1 | 2024-04-28 | led_msgs |
Messages for LEDs and LED strips
Messages for LEDs and LED strips
|
|
1 | 2024-04-26 | test_diagnostic_aggregator |
Basic diagnostic_aggregator tests are in the
Basic diagnostic_aggregator tests are in the
|
|
1 | 2024-04-26 | self_test |
self_test
self_test
|
|
1 | 2024-04-26 | rviz_imu_plugin |
RVIZ plugin for IMU visualization
RVIZ plugin for IMU visualization
|
|
1 | 2024-04-26 | rospy_message_converter |
Converts between Python dictionaries and JSON to rospy messages.
Converts between Python dictionaries and JSON to rospy messages.
|
|
1 | 2024-04-26 | rosdiagnostic |
Command to print aggregated diagnostic contents to the command line
Command to print aggregated diagnostic contents to the command line
|
|
1 | 2024-04-26 | phidgets_temperature |
Driver for the Phidgets Temperature devices
Driver for the Phidgets Temperature devices
|
|
1 | 2024-04-26 | phidgets_spatial |
Driver for the Phidgets Spatial 3/3/3 devices
Driver for the Phidgets Spatial 3/3/3 devices
|
|
1 | 2024-04-26 | phidgets_msgs |
Custom ROS messages for Phidgets drivers
Custom ROS messages for Phidgets drivers
|
|
1 | 2024-04-26 | phidgets_motors |
Driver for the Phidgets Motor devices
Driver for the Phidgets Motor devices
|
|
1 | 2024-04-26 | phidgets_magnetometer |
Driver for the Phidgets Magnetometer devices
Driver for the Phidgets Magnetometer devices
|
|
1 | 2024-04-26 | phidgets_ik |
Driver for the Phidgets InterfaceKit devices
Driver for the Phidgets InterfaceKit devices
|
|
1 | 2024-04-26 | phidgets_humidity |
Driver for the Phidgets Humidity devices
Driver for the Phidgets Humidity devices
|
|
1 | 2024-04-26 | phidgets_high_speed_encoder |
Driver for the Phidgets high speed encoder devices
Driver for the Phidgets high speed encoder devices
|
|
1 | 2024-04-26 | phidgets_gyroscope |
Driver for the Phidgets Gyroscope devices
Driver for the Phidgets Gyroscope devices
|
|
1 | 2024-04-26 | phidgets_drivers |
API and ROS drivers for Phidgets devices
API and ROS drivers for Phidgets devices
|
|
1 | 2024-04-26 | phidgets_digital_outputs |
Driver for the Phidgets Digital Output devices
Driver for the Phidgets Digital Output devices
|
|
1 | 2024-04-26 | phidgets_digital_inputs |
Driver for the Phidgets Digital Input devices
Driver for the Phidgets Digital Input devices
|
|
1 | 2024-04-26 | phidgets_api |
A C++ Wrapper for the Phidgets C API
A C++ Wrapper for the Phidgets C API
|
|
1 | 2024-04-26 | phidgets_analog_outputs |
Driver for the Phidgets Analog Output devices
Driver for the Phidgets Analog Output devices
|
|
1 | 2024-04-26 | phidgets_analog_inputs |
Driver for the Phidgets Analog Input devices
Driver for the Phidgets Analog Input devices
|
|
1 | 2024-04-26 | phidgets_accelerometer |
Driver for the Phidgets Accelerometer devices
Driver for the Phidgets Accelerometer devices
|
|
1 | 2024-04-26 | libphidget22 |
This package wraps the libphidget22 to use it as a ROS dependency
This package wraps the libphidget22 to use it as a ROS dependency
|
|
1 | 2024-04-26 | imu_tools |
Various tools for IMU devices
Various tools for IMU devices
|
|
1 | 2024-04-26 | imu_filter_madgwick |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into an orientation. Based on code by Sebastian Madgwick, http://www.x-io.co.uk/node/8#open_source_ahrs_and_imu_algorithms.
|
|
1 | 2024-04-26 | imu_complementary_filter |
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into a quaternion to represent the orientation of the device wrt the global frame. Based on the algorithm by Roberto G. Valenti etal. described in the paper "Keeping a Good Attitude: A Quaternion-Based Orientation Filter for IMUs and MARGs" available at http://www.mdpi.com/1424-8220/15/8/19302 .
Filter which fuses angular velocities, accelerations, and (optionally) magnetic readings from a generic IMU device into a quaternion to represent the orientation of the device wrt the global frame. Based on the algorithm by Roberto G. Valenti etal. described in the paper "Keeping a Good Attitude: A Quaternion-Based Orientation Filter for IMUs and MARGs" available at http://www.mdpi.com/1424-8220/15/8/19302 .
|
|
1 | 2024-04-26 | husky_viz |
Visualization configuration for Clearpath Husky
Visualization configuration for Clearpath Husky
|
|
1 | 2024-04-26 | husky_simulator |
Metapackage for Clearpath Husky simulation software
Metapackage for Clearpath Husky simulation software
|
|
1 | 2024-04-26 | husky_navigation |
Autonomous mapping and navigation demos for the Clearpath Husky
Autonomous mapping and navigation demos for the Clearpath Husky
|
|
1 | 2024-04-26 | husky_msgs |
Messages for Clearpath Husky
Messages for Clearpath Husky
|
|
1 | 2024-04-26 | husky_gazebo |
Clearpath Husky Simulator bringup
Clearpath Husky Simulator bringup
|
|
1 | 2024-04-26 | husky_desktop |
Metapackage for Clearpath Husky visualization software
Metapackage for Clearpath Husky visualization software
|
|
1 | 2024-04-26 | husky_description |
Clearpath Husky URDF description
Clearpath Husky URDF description
|
|
1 | 2024-04-26 | husky_control |
Clearpath Husky controller configurations
Clearpath Husky controller configurations
|
|
1 | 2024-04-26 | diagnostics |
diagnostics
diagnostics
|
|
1 | 2024-04-26 | diagnostic_updater |
diagnostic_updater contains tools for easily updating diagnostics. it is commonly used in device drivers to keep track of the status of output topics, device status, etc.
diagnostic_updater contains tools for easily updating diagnostics. it is commonly used in device drivers to keep track of the status of output topics, device status, etc.
|
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2022-02-17 | robot_state_publisher |
This package allows you to publish the state of a robot to
This package allows you to publish the state of a robot to
|
|
1 | 2022-02-14 | wiimote_msgs |
Messages used by wiimote package.
Messages used by wiimote package.
|
|
1 | 2022-02-14 | 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 | 2022-02-14 | spacenav |
ROS interface to the 3Dconnexion SpaceNavigator 6DOF joystick.
ROS interface to the 3Dconnexion SpaceNavigator 6DOF joystick.
|
|
1 | 2022-02-14 | sdl2_vendor |
Vendor library for SDL2.
Vendor library for SDL2.
|
|
1 | 2022-02-14 | joy_linux |
ROS2 driver for a generic Linux joystick.
Will contain a MacOS and Windows version later.
The joy package contains joy_node, a node that interfaces a
generic Linux joystick to ROS2. This node publishes a "Joy"
message, which contains the current state of each one of the
joystick's buttons and axes.
ROS2 driver for a generic Linux joystick.
Will contain a MacOS and Windows version later.
The joy package contains joy_node, a node that interfaces a
generic Linux joystick to ROS2. This node publishes a "Joy"
message, which contains the current state of each one of the
joystick's buttons and axes.
|
|
1 | 2022-02-14 | joy |
The joy package contains joy_node, a node that interfaces a
generic joystick to ROS 2. This node publishes a "Joy"
message, which contains the current state of each one of the
joystick's buttons and axes.
The joy package contains joy_node, a node that interfaces a
generic joystick to ROS 2. This node publishes a "Joy"
message, which contains the current state of each one of the
joystick's buttons and axes.
|
|
1 | 2022-02-08 | turtlebot3_teleop |
Teleoperation node using keyboard for TurtleBot3.
Teleoperation node using keyboard for TurtleBot3.
|
|
1 | 2022-02-08 | turtlebot3_node |
TurtleBot3 driver node that include diff drive controller, odometry and tf node
TurtleBot3 driver node that include diff drive controller, odometry and tf node
|
|
1 | 2022-02-08 | turtlebot3_navigation2 |
ROS 2 launch scripts for navigation2
ROS 2 launch scripts for navigation2
|
|
1 | 2022-02-08 | turtlebot3_example |
This package provides four basic examples for TurtleBot3 (i.e., interactive marker, object detection, patrol and position control).
This package provides four basic examples for TurtleBot3 (i.e., interactive marker, object detection, patrol and position control).
|
|
1 | 2022-02-08 | turtlebot3_description |
3D models of the TurtleBot3 for simulation and visualization
3D models of the TurtleBot3 for simulation and visualization
|
|
1 | 2022-02-08 | turtlebot3_cartographer |
ROS 2 launch scripts for cartographer
ROS 2 launch scripts for cartographer
|
|
1 | 2022-02-08 | turtlebot3_bringup |
ROS 2 launch scripts for starting the TurtleBot3
ROS 2 launch scripts for starting the TurtleBot3
|
|
1 | 2022-02-08 | turtlebot3 |
ROS 2 packages for TurtleBot3
ROS 2 packages for TurtleBot3
|
|
1 | 2022-02-08 | ackermann_msgs |
ROS2 messages for robots using Ackermann steering.
ROS2 messages for robots using Ackermann steering.
|
|
1 | 2022-02-03 | cyclonedds |
Eclipse Cyclone DDS is a very performant and robust open-source DDS implementation. Cyclone DDS is developed completely in the open as an Eclipse IoT project.
Eclipse Cyclone DDS is a very performant and robust open-source DDS implementation. Cyclone DDS is developed completely in the open as an Eclipse IoT project.
|
|
1 | 2022-01-26 | dolly_tests |
Tests for the Dolly robot.
Tests for the Dolly robot.
|
|
1 | 2022-01-26 | dolly_ignition |
Launch Ignition simulation with Dolly robot.
Launch Ignition simulation with Dolly robot.
|
|
1 | 2022-01-26 | dolly_gazebo |
Launch Gazebo simulation with Dolly robot.
Launch Gazebo simulation with Dolly robot.
|
|
1 | 2022-01-26 | dolly_follow |
Follow node for Dolly, the robot sheep.
Follow node for Dolly, the robot sheep.
|
|
1 | 2022-01-26 | dolly |
Meta-package for Dolly, the robot sheep.
Meta-package for Dolly, the robot sheep.
|
|
1 | 2022-01-20 | ament_package |
The parser for the manifest files in the ament buildsystem.
The parser for the manifest files in the ament buildsystem.
|
|
1 | 2022-01-19 | jlb_pid |
PID controller for ROS2.
PID controller for ROS2.
|
|
1 | 2022-01-19 | cudnn_cmake_module |
Exports a CMake module to find cuDNN.
Exports a CMake module to find cuDNN.
|
|
1 | 2022-01-14 | rqt_plot |
rqt_plot provides a GUI plugin visualizing numeric values in a 2D plot using different plotting backends.
rqt_plot provides a GUI plugin visualizing numeric values in a 2D plot using different plotting backends.
|
|
1 | 2022-01-14 | rqt_action |
rqt_action provides a feature to introspect all available ROS
action types. By utilizing rqt_msg, the output format is
unified with it and rqt_srv. Note that the actions shown on this plugin
is the ones that are stored on your machine, not on the ROS core your rqt
instance connects to.
rqt_action provides a feature to introspect all available ROS
action types. By utilizing rqt_msg, the output format is
unified with it and rqt_srv. Note that the actions shown on this plugin
is the ones that are stored on your machine, not on the ROS core your rqt
instance connects to.
|
|
1 | 2022-01-13 | sros2_cmake |
CMake macros to configure security
CMake macros to configure security
|
|
1 | 2022-01-13 | sros2 |
Command line tools for managing SROS2 keys
Command line tools for managing SROS2 keys
|
|
2 | 2022-01-12 | visualization_msgs |
A package containing some visualization and interaction related message definitions.
A package containing some visualization and interaction related message definitions.
|
|
2 | 2022-01-12 | trajectory_msgs |
A package containing some robot trajectory message definitions.
A package containing some robot trajectory message definitions.
|
|
2 | 2022-01-12 | stereo_msgs |
A package containing some stereo camera related message definitions.
A package containing some stereo camera related message definitions.
|
|
2 | 2022-01-12 | std_srvs |
A package containing some standard service definitions.
A package containing some standard service definitions.
|
|
2 | 2022-01-12 | std_msgs |
A package containing some standard message definitions.
A package containing some standard message definitions.
|
|
2 | 2022-01-12 | shape_msgs |
A package containing some message definitions which describe geometric shapes.
A package containing some message definitions which describe geometric shapes.
|
|
1 | 2022-01-12 | sensor_msgs_py |
A package for easy creation and reading of PointCloud2 messages in Python.
A package for easy creation and reading of PointCloud2 messages in Python.
|
|
2 | 2022-01-12 | sensor_msgs |
A package containing some sensor data related message and service definitions.
A package containing some sensor data related message and service definitions.
|
|
2 | 2022-01-12 | nav_msgs |
A package containing some navigation related message and service definitions.
A package containing some navigation related message and service definitions.
|
|
2 | 2022-01-12 | geometry_msgs |
A package containing some geometry related message definitions.
A package containing some geometry related message definitions.
|
|
2 | 2022-01-12 | diagnostic_msgs |
A package containing some diagnostics related message and service definitions.
A package containing some diagnostics related message and service definitions.
|
|
1 | 2022-01-12 | common_interfaces |
common_interfaces contains messages and services that are widely used by other ROS packages.
common_interfaces contains messages and services that are widely used by other ROS packages.
|
|
2 | 2022-01-12 | actionlib_msgs |
A package containing some message definitions used in the implementation of ROS 1 actions.
A package containing some message definitions used in the implementation of ROS 1 actions.
|
|
1 | 2021-12-15 | spatio_temporal_voxel_layer |
The spatio-temporal 3D obstacle costmap package
The spatio-temporal 3D obstacle costmap package
|
|
1 | 2021-12-15 | aws_robomaker_small_warehouse_world |
AWS RoboMaker package for a warehouse world to use in manufacturing and logistics robot applications.
AWS RoboMaker package for a warehouse world to use in manufacturing and logistics robot applications.
|
|
1 | 2021-12-07 | yaml_cpp_vendor |
Wrapper around yaml-cpp, it provides a fixed CMake module and an ExternalProject build of it.
Wrapper around yaml-cpp, it provides a fixed CMake module and an ExternalProject build of it.
|
|
1 | 2021-12-07 | python_qt_binding |
This stack provides Python bindings for Qt.
There are two providers: pyside and pyqt. PySide2 is available under
the GPL, LGPL and a commercial license. PyQt is released under the GPL.
Both the bindings and tools to build bindings are included from each
available provider. For PySide, it is called "Shiboken". For PyQt,
this is called "SIP".
Also provided is adapter code to make the user's Python code
independent of which binding provider was actually used which makes
it very easy to switch between these.
This stack provides Python bindings for Qt.
There are two providers: pyside and pyqt. PySide2 is available under
the GPL, LGPL and a commercial license. PyQt is released under the GPL.
Both the bindings and tools to build bindings are included from each
available provider. For PySide, it is called "Shiboken". For PyQt,
this is called "SIP".
Also provided is adapter code to make the user's Python code
independent of which binding provider was actually used which makes
it very easy to switch between these.
|
|
1 | 2021-12-02 | snowbot_operating_system |
The weather outside is frightful
The weather outside is frightful
|
|
1 | 2021-12-02 | four_wheel_steering_msgs |
ROS messages for robots using FourWheelSteering.
ROS messages for robots using FourWheelSteering.
|
|
1 | 2021-12-01 | rmf_robot_sim_ignition_plugins |
ROS 2 Ignition plugins for TeleportIngestors and TeleportDispensers
ROS 2 Ignition plugins for TeleportIngestors and TeleportDispensers
|
|
1 | 2021-12-01 | rmf_robot_sim_gazebo_plugins |
ROS 2 Gazebo plugins for TeleportIngestors, TeleportDispensers and Readonly Objects
ROS 2 Gazebo plugins for TeleportIngestors, TeleportDispensers and Readonly Objects
|
|
1 | 2021-12-01 | rmf_robot_sim_common |
Common utility functions for Gazebo and ignition RMF plugins
Common utility functions for Gazebo and ignition RMF plugins
|
|
1 | 2021-12-01 | rmf_demos_tasks |
A package containing scripts for demos
A package containing scripts for demos
|
|
1 | 2021-12-01 | rmf_demos_panel |
Web based RMF Demo Panel
Web based RMF Demo Panel
|
|
1 | 2021-12-01 | rmf_demos_maps |
A package containing demo maps for rmf
A package containing demo maps for rmf
|
|
1 | 2021-12-01 | rmf_demos_ign |
Launch files for RMF demos using the Ignition simulator
Launch files for RMF demos using the Ignition simulator
|
|
1 | 2021-12-01 | rmf_demos_gz |
Launch files for RMF demos using the Gazebo simulator
Launch files for RMF demos using the Gazebo simulator
|
|
1 | 2021-12-01 | rmf_demos_dashboard_resources |
Resource pack for RMF dashboard
Resource pack for RMF dashboard
|
|
1 | 2021-12-01 | rmf_demos_assets |
Models and other media used for RMF demos
Models and other media used for RMF demos
|
|
1 | 2021-12-01 | rmf_demos |
Common launch files for RMF demos
Common launch files for RMF demos
|
|
1 | 2021-12-01 | rmf_building_sim_ignition_plugins |
Ignition gazebo plugins for building infrastructure simulation
Ignition gazebo plugins for building infrastructure simulation
|
|
1 | 2021-12-01 | rmf_building_sim_gazebo_plugins |
Gazebo plugins so that buildings generated by rmf_building_map_tools can
talk to the ROS 2-based systems in the rmf_traffic_ros2 package.
Gazebo plugins so that buildings generated by rmf_building_map_tools can
talk to the ROS 2-based systems in the rmf_traffic_ros2 package.
|
|
1 | 2021-12-01 | rmf_building_sim_common |
Common utility functions for Gazebo and ignition building plugins
Common utility functions for Gazebo and ignition building plugins
|
|
1 | 2021-11-29 | nonpersistent_voxel_layer |
include
This package provides an implementation of a 3D costmap that takes in sensor
data from the world, builds a 3D occupancy grid of the data for only one iteration.
include
This package provides an implementation of a 3D costmap that takes in sensor
data from the world, builds a 3D occupancy grid of the data for only one iteration.
|
|
1 | 2021-11-26 | twist_mux |
Twist multiplexer, which multiplex several velocity commands (topics) and
allows to priorize or disable them (locks).
Twist multiplexer, which multiplex several velocity commands (topics) and
allows to priorize or disable them (locks).
|
|
1 | 2021-11-08 | plotjuggler_msgs |
Special Messages for PlotJuggler
Special Messages for PlotJuggler
|
|
1 | 2021-11-03 | realtime_tools |
Contains a set of tools that can be used from a hard
realtime thread, without breaking the realtime behavior.
Contains a set of tools that can be used from a hard
realtime thread, without breaking the realtime behavior.
|
|
2 | 2021-10-29 | 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 | 2021-10-29 | cartographer_ros_msgs |
ROS messages for the cartographer_ros package.
ROS messages for the cartographer_ros package.
|
|
2 | 2021-10-29 | 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.
|
|
1 | 2021-10-27 | rmf_traffic |
Package for managing traffic in the Robotics Middleware Framework
Package for managing traffic in the Robotics Middleware Framework
|
|
1 | 2021-10-27 | rmf_battery |
Package for modelling battery life of robots
Package for modelling battery life of robots
|
|
1 | 2021-10-27 | nodl_to_policy |
Package to generate a ROS 2 Access Control Policy from the NoDL description of a ROS system
Package to generate a ROS 2 Access Control Policy from the NoDL description of a ROS system
|
|
1 | 2021-10-22 | domain_bridge |
ROS 2 Domain Bridge
ROS 2 Domain Bridge
|
|
1 | 2021-10-11 | fastrtps |
*eprosima Fast DDS* (formerly Fast RTPS) is a C++ implementation of the DDS (Data Distribution Service) standard of the OMG (Object Management Group). eProsima Fast DDS implements the RTPS (Real Time Publish Subscribe) protocol, which provides publisher-subscriber communications over unreliable transports such as UDP, as defined and maintained by the Object Management Group (OMG) consortium. RTPS is also the wire interoperability protocol defined for the Data Distribution Service (DDS) standard. *eProsima Fast DDS* expose an API to access directly the RTPS protocol, giving the user full access to the protocol internals.
*eprosima Fast DDS* (formerly Fast RTPS) is a C++ implementation of the DDS (Data Distribution Service) standard of the OMG (Object Management Group). eProsima Fast DDS implements the RTPS (Real Time Publish Subscribe) protocol, which provides publisher-subscriber communications over unreliable transports such as UDP, as defined and maintained by the Object Management Group (OMG) consortium. RTPS is also the wire interoperability protocol defined for the Data Distribution Service (DDS) standard. *eProsima Fast DDS* expose an API to access directly the RTPS protocol, giving the user full access to the protocol internals.
|
|
1 | 2021-09-28 | joint_state_publisher_gui |
This package contains a GUI tool for setting and publishing joint state values for a given URDF.
This package contains a GUI tool for setting and publishing joint state values for a given URDF.
|
|
1 | 2021-09-28 | 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.
|
|
2 | 2021-09-24 | teleop_twist_joy |
Generic joystick teleop for twist robots.
Generic joystick teleop for twist robots.
|
|
1 | 2021-09-23 | rqt_runtime_monitor |
rqt_runtime_monitor provides a GUI plugin viewing DiagnosticsArray messages.
rqt_runtime_monitor provides a GUI plugin viewing DiagnosticsArray messages.
|
|
1 | 2021-09-14 | perception_pcl |
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
|
|
1 | 2021-09-14 | pcl_ros |
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred
bridge for 3D applications involving n-D Point Clouds and 3D geometry
processing in ROS.
|
|
1 | 2021-09-14 | pcl_conversions |
Provides conversions from PCL data types and ROS message types
Provides conversions from PCL data types and ROS message types
|
|
1 | 2021-09-10 | rqt_moveit |
An rqt-based tool that assists monitoring tasks
for
An rqt-based tool that assists monitoring tasks
for
|
|
1 | 2021-09-10 | async_web_server_cpp |
Asynchronous Web/WebSocket Server in C++
Asynchronous Web/WebSocket Server in C++
|
|
1 | 2021-09-02 | rmf_workcell_msgs |
A package containing messages used by all workcells generically to interfact with rmf_core
A package containing messages used by all workcells generically to interfact with rmf_core
|
|
1 | 2021-09-02 | rmf_traffic_ros2 |
A package containing messages used by the RMF traffic management system.
A package containing messages used by the RMF traffic management system.
|
|
1 | 2021-09-02 | rmf_traffic_msgs |
A package containing messages used by the RMF traffic management system.
A package containing messages used by the RMF traffic management system.
|
|
1 | 2021-09-02 | rmf_traffic_editor_test_maps |
Some test maps for traffic_editor and rmf_building_map_tools.
Some test maps for traffic_editor and rmf_building_map_tools.
|
|
1 | 2021-09-02 | rmf_traffic_editor_assets |
Assets for use with traffic_editor.
Assets for use with traffic_editor.
|
|
1 | 2021-09-02 | rmf_traffic_editor |
traffic editor
traffic editor
|
|
1 | 2021-09-02 | rmf_task_ros2 |
A package managing the dispatching of tasks in RMF system.
A package managing the dispatching of tasks in RMF system.
|
|
1 | 2021-09-02 | rmf_task_msgs |
A package containing messages used to specify tasks
A package containing messages used to specify tasks
|
|
1 | 2021-09-02 | rmf_lift_msgs |
Messages used to interface to lifts.
Messages used to interface to lifts.
|
|
1 | 2021-09-02 | rmf_ingestor_msgs |
A package containing messages used to interface to ingestor workcells
A package containing messages used to interface to ingestor workcells
|
|
1 | 2021-09-02 | rmf_fleet_msgs |
A package containing messages used to interface to fleet managers
A package containing messages used to interface to fleet managers
|
|
1 | 2021-09-02 | rmf_fleet_adapter_python |
Python bindings for the rmf_fleet_adapter
Python bindings for the rmf_fleet_adapter
|
|
1 | 2021-09-02 | rmf_fleet_adapter |
Fleet Adapter package for RMF fleets.
Fleet Adapter package for RMF fleets.
|
|
1 | 2021-09-02 | rmf_door_msgs |
Messages used to interface to doors
Messages used to interface to doors
|
|
1 | 2021-09-02 | rmf_dispenser_msgs |
A package containing messages used to interface to dispenser workcells
A package containing messages used to interface to dispenser workcells
|
|
1 | 2021-09-02 | rmf_charger_msgs |
This package contains messages regarding charging and discharging
This package contains messages regarding charging and discharging
|
|
1 | 2021-09-02 | rmf_building_map_tools |
RMF Building map tools
RMF Building map tools
|
|
1 | 2021-09-01 | rmf_visualization_schedule |
A visualizer for trajectories in rmf schedule
A visualizer for trajectories in rmf schedule
|
|
1 | 2021-09-01 | rmf_visualization_rviz2_plugins |
A package containing RViz2 plugins for RMF
A package containing RViz2 plugins for RMF
|
|
1 | 2021-09-01 | rmf_visualization_fleet_states |
Fleet state visualizer
Fleet state visualizer
|
|
1 | 2021-09-01 | rmf_visualization_building_systems |
A visualizer for doors and lifts
A visualizer for doors and lifts
|
|
1 | 2021-09-01 | rmf_visualization |
Package containing a single launch file to bringup various visualizations
Package containing a single launch file to bringup various visualizations
|
|
1 | 2021-09-01 | rmf_task |
Package for managing tasks in the Robotics Middleware Framework
Package for managing tasks in the Robotics Middleware Framework
|
|
1 | 2021-08-31 | rqt_top |
RQT plugin for monitoring ROS processes.
RQT plugin for monitoring ROS processes.
|
|
1 | 2021-08-31 | rqt_srv |
A Python GUI plugin for introspecting available ROS message types.
Note that the srvs available through this plugin is the ones that are stored
on your machine, not on the ROS core your rqt instance connects to.
A Python GUI plugin for introspecting available ROS message types.
Note that the srvs available through this plugin is the ones that are stored
on your machine, not on the ROS core your rqt instance connects to.
|
|
1 | 2021-08-31 | rqt_shell |
rqt_shell is a Python GUI plugin providing an interactive shell.
rqt_shell is a Python GUI plugin providing an interactive shell.
|
|
1 | 2021-08-31 | rqt_service_caller |
rqt_service_caller provides a GUI plugin for calling arbitrary services.
rqt_service_caller provides a GUI plugin for calling arbitrary services.
|
|
1 | 2021-08-31 | rqt_py_console |
rqt_py_console is a Python GUI plugin providing an interactive Python console.
rqt_py_console is a Python GUI plugin providing an interactive Python console.
|
|
1 | 2021-08-31 | rqt_py_common |
rqt_py_common provides common functionality for rqt plugins written in Python.
Despite no plugin is provided, this package is part of the rqt_common_plugins
repository to keep refactoring generic functionality from these common plugins
into this package as easy as possible.
Functionality included in this package should cover generic ROS concepts and
should not introduce any special dependencies beside "ros_base".
rqt_py_common provides common functionality for rqt plugins written in Python.
Despite no plugin is provided, this package is part of the rqt_common_plugins
repository to keep refactoring generic functionality from these common plugins
into this package as easy as possible.
Functionality included in this package should cover generic ROS concepts and
should not introduce any special dependencies beside "ros_base".
|
|
1 | 2021-08-31 | rqt_gui_py |
rqt_gui_py enables GUI plugins to use the Python client library for ROS.
rqt_gui_py enables GUI plugins to use the Python client library for ROS.
|
|
1 | 2021-08-31 | rqt_gui_cpp |
rqt_gui_cpp enables GUI plugins to use the C++ client library for ROS.
rqt_gui_cpp enables GUI plugins to use the C++ client library for ROS.
|
|
1 | 2021-08-31 | rqt_gui |
rqt_gui provides the main to start an instance of the ROS integrated graphical user interface provided by qt_gui.
rqt_gui provides the main to start an instance of the ROS integrated graphical user interface provided by qt_gui.
|
|
1 | 2021-08-31 | rqt |
rqt is a Qt-based framework for GUI development for ROS. It consists of three parts/metapackages
rqt is a Qt-based framework for GUI development for ROS. It consists of three parts/metapackages
|
|
1 | 2021-08-30 | micro_ros_msgs |
Definitions for the ROS 2 msgs entities information used by micro-ROS to leverage its functionality to the same level as ROS 2, by means of a dedicated graph manager
Definitions for the ROS 2 msgs entities information used by micro-ROS to leverage its functionality to the same level as ROS 2, by means of a dedicated graph manager
|
|
1 | 2021-08-25 | automotive_platform_msgs |
Generic Messages for Communication with an Automotive Autonomous Platform
Generic Messages for Communication with an Automotive Autonomous Platform
|
|
1 | 2021-08-25 | automotive_navigation_msgs |
Generic Messages for Navigation Objectives in Automotive Automation Software
Generic Messages for Navigation Objectives in Automotive Automation Software
|
|
1 | 2021-08-25 | automotive_autonomy_msgs |
Messages for vehicle automation
Messages for vehicle automation
|
|
1 | 2021-08-12 | picknik_ament_copyright |
Check PickNik-specific copyright headers.
Check PickNik-specific copyright headers.
|
|
1 | 2021-08-11 | ros2launch_security_examples |
Examples of how to use the ros2launch_security extension.
Examples of how to use the ros2launch_security extension.
|
|
1 | 2021-08-11 | ros2launch_security |
Security extensions for ros2 launch
Security extensions for ros2 launch
|
|
1 | 2021-08-05 | libstatistics_collector |
Lightweight aggregation utilities to collect statistics and measure message metrics.
Lightweight aggregation utilities to collect statistics and measure message metrics.
|
|
1 | 2021-07-15 | hls_lfcd_lds_driver |
ROS package for LDS(HLS-LFCD2).
The LDS (Laser Distance Sensor) is a sensor sending the data to Host for the simultaneous localization and mapping (SLAM). Simultaneously the detecting obstacle data can also be sent to Host. HLDS(Hitachi-LG Data Storage) is developing the technology for the moving platform sensor such as Robot Vacuum Cleaners, Home Robot, Robotics Lawn Mower Sensor, etc.
ROS package for LDS(HLS-LFCD2).
The LDS (Laser Distance Sensor) is a sensor sending the data to Host for the simultaneous localization and mapping (SLAM). Simultaneously the detecting obstacle data can also be sent to Host. HLDS(Hitachi-LG Data Storage) is developing the technology for the moving platform sensor such as Robot Vacuum Cleaners, Home Robot, Robotics Lawn Mower Sensor, etc.
|
|
1 | 2021-07-03 | popf |
The POPF package
The POPF package
|
|
1 | 2021-06-30 | ament_index_python |
Python API to access the ament resource index.
Python API to access the ament resource index.
|
|
1 | 2021-06-30 | ament_index_cpp |
C++ API to access the ament resource index.
C++ API to access the ament resource index.
|
|
2 | 2021-06-24 | qpoases_vendor |
Wrapper around qpOASES to make it available to the ROS ecosystem.
Wrapper around qpOASES to make it available to the ROS ecosystem.
|
|
1 | 2021-06-22 | rmf_utils |
Simple C++ programming utilities used by Robotics Middleware Framework packages
Simple C++ programming utilities used by Robotics Middleware Framework packages
|
|
1 | 2021-06-22 | rmf_cmake_uncrustify |
ament_cmake_uncrustify with support for parsing a config file.
ament_cmake_uncrustify with support for parsing a config file.
|
|
1 | 2021-06-21 | dynamixel_sdk_examples |
ROS2 examples using ROBOTIS DYNAMIXEL SDK
ROS2 examples using ROBOTIS DYNAMIXEL SDK
|
|
1 | 2021-06-21 | dynamixel_sdk_custom_interfaces |
ROS2 custom interface examples using ROBOTIS DYNAMIXEL SDK
ROS2 custom interface examples using ROBOTIS DYNAMIXEL SDK
|
|
1 | 2021-06-21 | dynamixel_sdk |
This package is wrapping version of ROBOTIS Dynamixel SDK for ROS 2. The ROBOTIS Dynamixel SDK, or SDK, is a software development library that provides Dynamixel control functions for packet communication. The API is designed for Dynamixel actuators and Dynamixel-based platforms.
This package is wrapping version of ROBOTIS Dynamixel SDK for ROS 2. The ROBOTIS Dynamixel SDK, or SDK, is a software development library that provides Dynamixel control functions for packet communication. The API is designed for Dynamixel actuators and Dynamixel-based platforms.
|
|
1 | 2021-06-14 | turtlebot3_simulations |
ROS 2 packages for TurtleBot3 simulations
ROS 2 packages for TurtleBot3 simulations
|
|
1 | 2021-06-14 | turtlebot3_gazebo |
Gazebo simulation package for the TurtleBot3
Gazebo simulation package for the TurtleBot3
|
|
1 | 2021-06-14 | turtlebot3_fake_node |
Package for TurtleBot3 fake node. With this package, simple tests can be done without a robot.
You can do simple tests using this package on rviz without real robots.
Package for TurtleBot3 fake node. With this package, simple tests can be done without a robot.
You can do simple tests using this package on rviz without real robots.
|
|
1 | 2021-06-13 | turtlebot3_msgs |
Message and service types: custom messages and services for TurtleBot3 packages for ROS2
Message and service types: custom messages and services for TurtleBot3 packages for ROS2
|
|
2 | 2021-06-11 | sdc21x0 |
Message definitions for the sdc21x0 motor controller
Message definitions for the sdc21x0 motor controller
|
|
2 | 2021-06-11 | mir_robot |
URDF description, Gazebo simulation, navigation, bringup launch files, message and action descriptions for the MiR100 robot.
URDF description, Gazebo simulation, navigation, bringup launch files, message and action descriptions for the MiR100 robot.
|
|
2 | 2021-06-11 | mir_navigation |
Launch and configuration files for move_base, localization etc. on the MiR robot.
Launch and configuration files for move_base, localization etc. on the MiR robot.
|
|
2 | 2021-06-11 | mir_msgs |
Message definitions for the MiR100 robot
Message definitions for the MiR100 robot
|
|
2 | 2021-06-11 | mir_gazebo |
Simulation specific launch and configuration files for the MiR100 robot.
Simulation specific launch and configuration files for the MiR100 robot.
|
|
2 | 2021-06-11 | mir_dwb_critics |
Trajectory critics for the dwb_local_planner that work well together with the SBPL global planner on the MiR robot
Trajectory critics for the dwb_local_planner that work well together with the SBPL global planner on the MiR robot
|
|
2 | 2021-06-11 | mir_driver |
A reverse ROS bridge for the MiR100 robot
A reverse ROS bridge for the MiR100 robot
|
|
2 | 2021-06-11 | mir_description |
URDF description of the MiR100 robot
URDF description of the MiR100 robot
|
|
2 | 2021-06-11 | mir_actions |
Action definitions for the MiR100 robot
Action definitions for the MiR100 robot
|
|
1 | 2021-06-10 | stubborn_buddies_msgs |
Messages to support library of stubborn buddies
Messages to support library of stubborn buddies
|
|
1 | 2021-06-10 | stubborn_buddies |
Demo that uses node composition of lifecycle nodes to achieve fail-over robustness on ROS nodes
Demo that uses node composition of lifecycle nodes to achieve fail-over robustness on ROS nodes
|
|
1 | 2021-06-10 | rmf_visualization_msgs |
A package containing messages used for visualizations
A package containing messages used for visualizations
|
|
1 | 2021-06-10 | point_cloud_msg_wrapper |
A point cloud message wrapper that allows for simple and safe PointCloud2 msg usage
A point cloud message wrapper that allows for simple and safe PointCloud2 msg usage
|
|
1 | 2021-06-04 | gtest_vendor |
The package provides GoogleTest.
The package provides GoogleTest.
|
|
1 | 2021-06-04 | gmock_vendor |
The package provides GoogleMock.
The package provides GoogleMock.
|
|
1 | 2021-05-28 | menge_vendor |
Menge is a powerful, cross-platform, modular framework for crowd simulation developed at the University of North Carolina - Chapel Hill. This package includes the core simulation part of origin menge package, with a bit modification for crowd simulation in gazebo and ignition gazebo.
Menge is a powerful, cross-platform, modular framework for crowd simulation developed at the University of North Carolina - Chapel Hill. This package includes the core simulation part of origin menge package, with a bit modification for crowd simulation in gazebo and ignition gazebo.
|
|
1 | 2021-05-18 | rosbag2_bag_v2_plugins |
Package containing storage and converter plugins for rosbag 1
Package containing storage and converter plugins for rosbag 1
|
|
1 | 2021-05-18 | ros1_rosbag_storage_vendor |
Vendor package for rosbag_storage of ROS1
Vendor package for rosbag_storage of ROS1
|
|
2 | 2021-05-12 | urdf_parser_plugin |
This package contains a C++ base class for URDF parsers.
This package contains a C++ base class for URDF parsers.
|
|
2 | 2021-05-12 | urdf |
This package contains a C++ parser for the Unified Robot Description
Format (URDF), which is an XML format for representing a robot model.
The code API of the parser has been through our review process and will remain
backwards compatible in future releases.
This package contains a C++ parser for the Unified Robot Description
Format (URDF), which is an XML format for representing a robot model.
The code API of the parser has been through our review process and will remain
backwards compatible in future releases.
|
|
1 | 2021-05-12 | rosidl_generator_dds_idl |
Generate the DDS interfaces for ROS interfaces.
Generate the DDS interfaces for ROS interfaces.
|
|
1 | 2021-05-12 | python_cmake_module |
Provide CMake module with extra functionality for Python.
Provide CMake module with extra functionality for Python.
|
|
2 | 2021-05-12 | message_filters |
A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
|
|
1 | 2021-05-12 | 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 | 2021-05-12 | example_interfaces |
Contains message and service definitions used by the examples.
Contains message and service definitions used by the examples.
|
|
1 | 2021-05-12 | domain_coordinator |
A tool to coordinate unique ROS_DOMAIN_IDs across multiple processes
A tool to coordinate unique ROS_DOMAIN_IDs across multiple processes
|
|
1 | 2021-05-12 | ament_cmake_ros |
The ROS specific CMake bits in the ament buildsystem.
The ROS specific CMake bits in the ament buildsystem.
|
|
1 | 2021-05-10 | rqt_reconfigure |
This rqt plugin provides a way to view and edit parameters on nodes.
This rqt plugin provides a way to view and edit parameters on nodes.
|
|
1 | 2021-05-06 | tracetools_trace |
Tools for setting up tracing sessions.
Tools for setting up tracing sessions.
|
|
1 | 2021-05-06 | tracetools_test |
Testing utilities and tests for the tracetools package.
Testing utilities and tests for the tracetools package.
|
|
1 | 2021-05-06 | tracetools_read |
Tools for reading traces.
Tools for reading traces.
|
|
1 | 2021-05-06 | tracetools_launch |
Launch integration for tracing.
Launch integration for tracing.
|
|
2 | 2021-05-06 | tracetools |
Tracing wrapper for ROS 2.
Tracing wrapper for ROS 2.
|
|
1 | 2021-05-06 | ros2trace |
The trace command for ROS 2 command line tools.
The trace command for ROS 2 command line tools.
|
|
1 | 2021-05-01 | apex_containers |
Containers
Containers
|
|
1 | 2021-04-29 | qt_gui_py_common |
qt_gui_py_common provides common functionality for GUI plugins written in Python.
qt_gui_py_common provides common functionality for GUI plugins written in Python.
|
|
1 | 2021-04-29 | qt_gui_cpp |
qt_gui_cpp provides the foundation for C++-bindings for qt_gui and creates bindings for every generator available.
At least one specific binding must be available in order to use C++-plugins.
qt_gui_cpp provides the foundation for C++-bindings for qt_gui and creates bindings for every generator available.
At least one specific binding must be available in order to use C++-plugins.
|
|
1 | 2021-04-29 | qt_gui_core |
Integration of the ROS package system and ROS-specific plugins for a Qt-based GUI.
Integration of the ROS package system and ROS-specific plugins for a Qt-based GUI.
|
|
1 | 2021-04-29 | qt_gui_app |
qt_gui_app provides the main to start an instance of the integrated graphical user interface provided by qt_gui.
qt_gui_app provides the main to start an instance of the integrated graphical user interface provided by qt_gui.
|
|
1 | 2021-04-29 | qt_gui |
qt_gui provides the infrastructure for an integrated graphical user interface based on Qt.
It is extensible with Python- and C++-based plugins (implemented in separate packages) which can contribute arbitrary widgets.
It requires either PyQt or PySide bindings.
qt_gui provides the infrastructure for an integrated graphical user interface based on Qt.
It is extensible with Python- and C++-based plugins (implemented in separate packages) which can contribute arbitrary widgets.
It requires either PyQt or PySide bindings.
|
|
1 | 2021-04-29 | qt_dotgraph |
qt_dotgraph provides helpers to work with dot graphs.
qt_dotgraph provides helpers to work with dot graphs.
|
|
1 | 2021-04-27 | urdfdom |
A library to access URDFs using the DOM model.
A library to access URDFs using the DOM model.
|
|
2 | 2021-04-27 | tracetools_analysis |
Tools for analysing trace data.
Tools for analysing trace data.
|
|
2 | 2021-04-27 | ros2trace_analysis |
The trace-analysis command for ROS 2 command line tools.
The trace-analysis command for ROS 2 command line tools.
|
|
1 | 2021-04-26 | rmw_implementation_cmake |
CMake functions which can discover and enumerate available implementations.
CMake functions which can discover and enumerate available implementations.
|
|
1 | 2021-04-26 | rmw |
Contains the ROS middleware API.
Contains the ROS middleware API.
|
|
1 | 2021-04-26 | examples_rclpy_pointcloud_publisher |
Example on how to publish a Pointcloud2 message
Example on how to publish a Pointcloud2 message
|
|
1 | 2021-04-26 | examples_rclpy_minimal_subscriber |
Examples of minimal subscribers using rclpy.
Examples of minimal subscribers using rclpy.
|
|
1 | 2021-04-26 | examples_rclpy_minimal_service |
Examples of minimal service servers using rclpy.
Examples of minimal service servers using rclpy.
|
|
1 | 2021-04-26 | examples_rclpy_minimal_publisher |
Examples of minimal publishers using rclpy.
Examples of minimal publishers using rclpy.
|
|
1 | 2021-04-26 | examples_rclpy_minimal_client |
Examples of minimal service clients using rclpy.
Examples of minimal service clients using rclpy.
|
|
1 | 2021-04-26 | examples_rclpy_minimal_action_server |
Examples of minimal action servers using rclpy.
Examples of minimal action servers using rclpy.
|
|
1 | 2021-04-26 | examples_rclpy_minimal_action_client |
Examples of minimal action clients using rclpy.
Examples of minimal action clients using rclpy.
|
|
1 | 2021-04-26 | examples_rclpy_guard_conditions |
Examples of using guard conditions.
Examples of using guard conditions.
|
|
1 | 2021-04-26 | examples_rclpy_executors |
Examples of creating and using exectors to run multiple nodes in the same process
Examples of creating and using exectors to run multiple nodes in the same process
|
|
1 | 2021-04-26 | examples_rclcpp_multithreaded_executor |
Package containing example of how to implement a multithreaded executor
Package containing example of how to implement a multithreaded executor
|
|
1 | 2021-04-26 | examples_rclcpp_minimal_timer |
Examples of minimal nodes which have timers
Examples of minimal nodes which have timers
|
|
1 | 2021-04-26 | examples_rclcpp_minimal_subscriber |
Examples of minimal subscribers
Examples of minimal subscribers
|
|
1 | 2021-04-26 | examples_rclcpp_minimal_service |
A minimal service server which adds two numbers
A minimal service server which adds two numbers
|
|
1 | 2021-04-26 | examples_rclcpp_minimal_publisher |
Examples of minimal publisher nodes
Examples of minimal publisher nodes
|
|
1 | 2021-04-26 | examples_rclcpp_minimal_composition |
Minimalist examples of composing nodes in the same
process
Minimalist examples of composing nodes in the same
process
|
|
1 | 2021-04-26 | examples_rclcpp_minimal_client |
Examples of minimal service clients
Examples of minimal service clients
|
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2024-07-11 | ament_cmake_pyflakes |
The CMake API for ament_pyflakes to check code using pyflakes.
The CMake API for ament_pyflakes to check code using pyflakes.
|
|
1 | 2024-07-11 | ament_cmake_pycodestyle |
The CMake API for ament_pycodestyle to check code against the style conventions in
PEP 8.
The CMake API for ament_pycodestyle to check code against the style conventions in
PEP 8.
|
|
1 | 2024-07-11 | ament_cmake_pep257 |
The CMake API for ament_pep257 to check code against the docstring style conventions in
PEP 257.
The CMake API for ament_pep257 to check code against the docstring style conventions in
PEP 257.
|
|
1 | 2024-07-11 | ament_cmake_pclint |
The CMake API for ament_pclint to perform static code analysis on C/C++
code using PC-lint.
The CMake API for ament_pclint to perform static code analysis on C/C++
code using PC-lint.
|
|
1 | 2024-07-11 | ament_cmake_mypy |
The CMake API for ament_mypy to perform static type analysis on python code
with mypy.
The CMake API for ament_mypy to perform static type analysis on python code
with mypy.
|
|
1 | 2024-07-11 | ament_cmake_lint_cmake |
The CMake API for ament_lint_cmake to lint CMake code using cmakelint.
The CMake API for ament_lint_cmake to lint CMake code using cmakelint.
|
|
1 | 2024-07-11 | ament_cmake_flake8 |
The CMake API for ament_flake8 to check code syntax and style conventions
with flake8.
The CMake API for ament_flake8 to check code syntax and style conventions
with flake8.
|
|
1 | 2024-07-11 | ament_cmake_cpplint |
The CMake API for ament_cpplint to lint C / C++ code using cpplint.
The CMake API for ament_cpplint to lint C / C++ code using cpplint.
|
|
1 | 2024-07-11 | ament_cmake_cppcheck |
The CMake API for ament_cppcheck to perform static code analysis on C/C++
code using Cppcheck.
The CMake API for ament_cppcheck to perform static code analysis on C/C++
code using Cppcheck.
|
|
1 | 2024-07-11 | ament_cmake_copyright |
The CMake API for ament_copyright to check every source file contains copyright reference.
The CMake API for ament_copyright to check every source file contains copyright reference.
|
|
1 | 2024-07-11 | ament_cmake_clang_tidy |
The CMake API for ament_clang_tidy to lint C / C++ code using clang tidy.
The CMake API for ament_clang_tidy to lint C / C++ code using clang tidy.
|
|
1 | 2024-07-11 | ament_cmake_clang_format |
The CMake API for ament_clang_format to lint C / C++ code using clang format.
The CMake API for ament_clang_format to lint C / C++ code using clang format.
|
|
1 | 2024-07-11 | ament_clang_tidy |
The ability to check code against style conventions using
clang-tidy and generate xUnit test result files.
The ability to check code against style conventions using
clang-tidy and generate xUnit test result files.
|
|
1 | 2024-07-11 | ament_clang_format |
The ability to check code against style conventions using
clang-format and generate xUnit test result files.
The ability to check code against style conventions using
clang-format and generate xUnit test result files.
|
|
1 | 2024-07-11 | action_tutorials_py |
Python action tutorial code
Python action tutorial code
|
|
1 | 2024-07-11 | action_tutorials_interfaces |
Action tutorials action
Action tutorials action
|
|
1 | 2024-07-11 | action_tutorials_cpp |
C++ action tutorial cpp code
C++ action tutorial cpp code
|
|
1 | 2024-07-10 | turtle_tf2_py |
turtle_tf2_py demonstrates how to write a ROS2 Python tf2 broadcaster and listener with the turtlesim. The turtle_tf2_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
turtle_tf2_py demonstrates how to write a ROS2 Python tf2 broadcaster and listener with the turtlesim. The turtle_tf2_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
|
|
1 | 2024-07-10 | turtle_tf2_cpp |
turtle_tf2_cpp demonstrates how to write a ROS2 C++ tf2 broadcaster and listener with the turtlesim. The turtle_tf2_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
turtle_tf2_cpp demonstrates how to write a ROS2 C++ tf2 broadcaster and listener with the turtlesim. The turtle_tf2_listener commands turtle2 to follow turtle1 around as you drive turtle1 using the keyboard.
|
|
1 | 2024-07-10 | geometry_tutorials |
Metapackage of geometry tutorials ROS.
Metapackage of geometry tutorials ROS.
|
|
1 | 2024-07-09 | open3d_conversions |
Provides conversion functions to and from Open3D datatypes
Provides conversion functions to and from Open3D datatypes
|
|
2 | 2024-07-07 | apriltag_ros |
AprilTag detection node
AprilTag detection node
|
|
1 | 2024-07-05 | metavision_driver |
ROS1 and ROS2 drivers for metavision based event cameras
ROS1 and ROS2 drivers for metavision based event cameras
|
|
1 | 2024-07-03 | test_ros_gz_bridge |
Bridge communication between ROS and Gazebo Transport
Bridge communication between ROS and Gazebo Transport
|
|
2 | 2024-07-03 | ros_ign_interfaces |
Shim package to redirect to ros_gz_interfaces.
Shim package to redirect to ros_gz_interfaces.
|
|
2 | 2024-07-03 | ros_ign_image |
Shim package to redirect to ros_gz_image.
Shim package to redirect to ros_gz_image.
|
|
2 | 2024-07-03 | ros_ign_gazebo_demos |
Shim package to redirect to ros_gz_sim_demos.
Shim package to redirect to ros_gz_sim_demos.
|
|
2 | 2024-07-03 | ros_ign_gazebo |
Shim package to redirect to ros_gz_sim.
Shim package to redirect to ros_gz_sim.
|
|
2 | 2024-07-03 | ros_ign_bridge |
Shim package to redirect to ros_gz_bridge.
Shim package to redirect to ros_gz_bridge.
|
|
2 | 2024-07-03 | ros_ign |
Shim meta-package to redirect to
Shim meta-package to redirect to
|
|
1 | 2024-07-03 | ros_gz_sim_demos |
Demos using Gazebo Sim simulation with ROS.
Demos using Gazebo Sim simulation with ROS.
|
|
1 | 2024-07-03 | ros_gz_sim |
Tools for using Gazebo Sim simulation with ROS.
Tools for using Gazebo Sim simulation with ROS.
|
|
1 | 2024-07-03 | ros_gz_point_cloud |
Point cloud utilities for Gazebo simulation with ROS.
Point cloud utilities for Gazebo simulation with ROS.
|
|
1 | 2024-07-03 | ros_gz_interfaces |
Message and service data structures for interacting with Gazebo from ROS2.
Message and service data structures for interacting with Gazebo from ROS2.
|
|
1 | 2024-07-03 | ros_gz_image |
Image utilities for Gazebo simulation with ROS.
Image utilities for Gazebo simulation with ROS.
|
|
1 | 2024-07-03 | ros_gz_bridge |
Bridge communication between ROS and Gazebo Transport
Bridge communication between ROS and Gazebo Transport
|
|
1 | 2024-07-03 | ros_gz |
Meta-package containing interfaces for using ROS 2 with
Meta-package containing interfaces for using ROS 2 with
|
|
1 | 2024-07-02 | vrpn_mocap |
ROS2
ROS2
|
|
1 | 2024-07-02 | udp_msgs |
ROS / ROS2 udp_msgs package
ROS / ROS2 udp_msgs package
|
|
1 | 2024-07-02 | social_nav_util |
Utilities for social navigation work
Utilities for social navigation work
|
|
1 | 2024-07-02 | social_nav_msgs |
ROS interfaces for social navigation
ROS interfaces for social navigation
|
|
1 | 2024-07-02 | social_nav_metrics |
Navigation metrics for navigating around people
Navigation metrics for navigating around people
|
|
1 | 2024-07-02 | octomap_server |
octomap_server loads a 3D map (as Octree-based OctoMap) and distributes it to other nodes in a compact binary format. It also allows to incrementally build 3D OctoMaps, and provides map saving in the node octomap_saver.
octomap_server loads a 3D map (as Octree-based OctoMap) and distributes it to other nodes in a compact binary format. It also allows to incrementally build 3D OctoMaps, and provides map saving in the node octomap_saver.
|
|
1 | 2024-07-02 | 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 | 2024-07-02 | octomap_mapping |
Mapping tools to be used with the
Mapping tools to be used with the
|
|
1 | 2024-07-02 | lidar_situational_graphs |
The lidar situational graphs package for generating 3D optimizable scene graphs
The lidar situational graphs package for generating 3D optimizable scene graphs
|
|
2 | 2024-07-02 | flexbe_widget |
flexbe_widget implements some smaller scripts for the behavior engine.
flexbe_widget implements some smaller scripts for the behavior engine.
|
|
2 | 2024-07-02 | flexbe_testing |
flexbe_testing provides a framework for unit testing states.
flexbe_testing provides a framework for unit testing states.
|
|
2 | 2024-07-02 | flexbe_states |
flexbe_states provides a collection of common generic predefined states.
flexbe_states provides a collection of common generic predefined states.
|
|
2 | 2024-07-02 | flexbe_onboard |
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
flexbe_onboard implements the robot-side of the behavior engine from where all behaviors are started.
|
|
2 | 2024-07-02 | flexbe_msgs |
flexbe_msgs provides the messages used by FlexBE.
flexbe_msgs provides the messages used by FlexBE.
|
|
2 | 2024-07-02 | flexbe_mirror |
flexbe_mirror implements functionality to remotely mirror an executed behavior.
flexbe_mirror implements functionality to remotely mirror an executed behavior.
|
|
2 | 2024-07-02 | flexbe_input |
flexbe_input enables to send data to onboard behavior when required.
flexbe_input enables to send data to onboard behavior when required.
|
|
2 | 2024-07-02 | flexbe_core |
flexbe_core provides the core components for the FlexBE behavior engine.
flexbe_core provides the core components for the FlexBE behavior engine.
|
|
2 | 2024-07-02 | flexbe_behavior_engine |
A meta-package to aggregate all the FlexBE packages
A meta-package to aggregate all the FlexBE packages
|
|
2 | 2024-07-02 | color_util |
An almost dependency-less library for converting between color spaces
An almost dependency-less library for converting between color spaces
|
|
1 | 2024-07-01 | zstd_point_cloud_transport |
zstd_point_cloud_transport provides a plugin to point_cloud_transport for sending point clouds
encoded with lib
zstd_point_cloud_transport provides a plugin to point_cloud_transport for sending point clouds
encoded with lib
|
|
1 | 2024-07-01 | zlib_point_cloud_transport |
zlib_point_cloud_transport provides a plugin to point_cloud_transport for sending point clouds
encoded with zlib
zlib_point_cloud_transport provides a plugin to point_cloud_transport for sending point clouds
encoded with zlib
|
|
1 | 2024-07-01 | template_point_cloud_transport |
template_point_cloud_transport is not a real transport plugin. It is just a template to reference when
making new point_cloud_transport plugins.
template_point_cloud_transport is not a real transport plugin. It is just a template to reference when
making new point_cloud_transport plugins.
|
|
1 | 2024-07-01 | rtabmap_viz |
RTAB-Map's visualization package.
RTAB-Map's visualization package.
|
|
1 | 2024-07-01 | rtabmap_util |
RTAB-Map's various useful nodes and nodelets.
RTAB-Map's various useful nodes and nodelets.
|
|
1 | 2024-07-01 | rtabmap_sync |
RTAB-Map's synchronization package.
RTAB-Map's synchronization package.
|
|
1 | 2024-07-01 | rtabmap_slam |
RTAB-Map's SLAM package.
RTAB-Map's SLAM package.
|
|
1 | 2024-07-01 | rtabmap_rviz_plugins |
RTAB-Map's rviz plugins.
RTAB-Map's rviz plugins.
|
|
1 | 2024-07-01 | rtabmap_ros |
RTAB-Map Stack
RTAB-Map Stack
|
|
1 | 2024-07-01 | rtabmap_python |
RTAB-Map's python package.
RTAB-Map's python package.
|
|
1 | 2024-07-01 | rtabmap_odom |
RTAB-Map's odometry package.
RTAB-Map's odometry package.
|
|
1 | 2024-07-01 | rtabmap_msgs |
RTAB-Map's msgs package.
RTAB-Map's msgs package.
|
|
1 | 2024-07-01 | rtabmap_launch |
RTAB-Map's main launch files.
RTAB-Map's main launch files.
|
|
1 | 2024-07-01 | rtabmap_examples |
RTAB-Map's example launch files.
RTAB-Map's example launch files.
|
|
1 | 2024-07-01 | rtabmap_demos |
RTAB-Map's demo launch files.
RTAB-Map's demo launch files.
|
|
1 | 2024-07-01 | rtabmap_conversions |
RTAB-Map's conversions package. This package can be used to convert rtabmap_msgs's msgs into RTAB-Map's library objects.
RTAB-Map's conversions package. This package can be used to convert rtabmap_msgs's msgs into RTAB-Map's library objects.
|
|
2 | 2024-07-01 | point_cloud_transport_plugins |
Metapackage with common point_cloud_transport plugins
Metapackage with common point_cloud_transport plugins
|
|
1 | 2024-07-01 | point_cloud_interfaces |
msg definitions for use with point_cloud_transport plugins.
msg definitions for use with point_cloud_transport plugins.
|
|
2 | 2024-07-01 | draco_point_cloud_transport |
draco_point_cloud_transport provides a plugin to point_cloud_transport for sending point clouds
encoded with KD tree compression.
draco_point_cloud_transport provides a plugin to point_cloud_transport for sending point clouds
encoded with KD tree compression.
|
|
1 | 2024-06-28 | flex_sync |
ros2 package for syncing variable number of topics
ros2 package for syncing variable number of topics
|
|
1 | 2024-06-27 | situational_graphs_wrapper |
Graph wrapper for situational_graphs_wrapper repo
Graph wrapper for situational_graphs_wrapper repo
|
|
1 | 2024-06-27 | situational_graphs_reasoning_msgs |
Custom reasoning msgs
Custom reasoning msgs
|
|
1 | 2024-06-27 | situational_graphs_datasets |
Graph datasets for situational_graphs_reasoning repo
Graph datasets for situational_graphs_reasoning repo
|
|
1 | 2024-06-27 | find_object_2d |
The find_object_2d package
The find_object_2d package
|
|
2 | 2024-06-26 | tracetools_analysis |
Tools for analysing trace data.
Tools for analysing trace data.
|
|
2 | 2024-06-26 | ros2trace_analysis |
The trace-analysis command for ROS 2 command line tools.
The trace-analysis command for ROS 2 command line tools.
|
|
1 | 2024-06-24 | test_launch_testing |
Tests for the launch_testing package.
Tests for the launch_testing package.
|
|
1 | 2024-06-24 | launch_yaml |
YAML frontend for the launch package.
YAML frontend for the launch package.
|
|
1 | 2024-06-24 | launch_xml |
XML frontend for the launch package.
XML frontend for the launch package.
|
|
1 | 2024-06-24 | launch_testing_ament_cmake |
A package providing cmake functions for running launch tests from the build.
A package providing cmake functions for running launch tests from the build.
|
|
1 | 2024-06-24 | launch_testing |
A package to create tests which involve launch files and multiple processes.
A package to create tests which involve launch files and multiple processes.
|
|
1 | 2024-06-24 | launch_pytest |
A package to create tests which involve launch files and multiple processes.
A package to create tests which involve launch files and multiple processes.
|
|
1 | 2024-06-24 | launch |
The ROS launch tool.
The ROS launch tool.
|
|
1 | 2024-06-22 | usb_cam |
A ROS Driver for V4L USB Cameras
A ROS Driver for V4L USB Cameras
|
|
1 | 2024-06-17 | librealsense2 |
Library for controlling and capturing data from the Intel(R) RealSense(TM) D400 devices.
Library for controlling and capturing data from the Intel(R) RealSense(TM) D400 devices.
|
|
1 | 2024-06-14 | rqt_tf_tree |
rqt_tf_tree provides a GUI plugin for visualizing the ROS TF frame tree.
rqt_tf_tree provides a GUI plugin for visualizing the ROS TF frame tree.
|
|
2 | 2024-06-13 | kobuki_core |
Pure C++ driver library for Kobuki.
Pure C++ driver library for Kobuki.
|
|
1 | 2024-06-12 | rmf_dev |
A package to aggregate the packages required for a minimal installation of Open-RMF
A package to aggregate the packages required for a minimal installation of Open-RMF
|
|
1 | 2024-06-11 | iceoryx_posh |
Eclipse iceoryx inter-process-communication (IPC) middleware Posix Shared Memory Library and middleware daemon (RouDi)
Eclipse iceoryx inter-process-communication (IPC) middleware Posix Shared Memory Library and middleware daemon (RouDi)
|
|
1 | 2024-06-11 | iceoryx_introspection |
Eclipse iceoryx inter-process-communication (IPC) middleware introspection client
Eclipse iceoryx inter-process-communication (IPC) middleware introspection client
|
|
1 | 2024-06-11 | iceoryx_integrationtest |
iceoryx Software Integrationtest
iceoryx Software Integrationtest
|
|
1 | 2024-06-11 | iceoryx_hoofs |
Eclipse iceoryx inter-process-communication (IPC) middleware basic building blocks
Eclipse iceoryx inter-process-communication (IPC) middleware basic building blocks
|
|
1 | 2024-06-11 | iceoryx_binding_c |
Eclipse iceoryx inter-process-communication (IPC) middleware C-Language Binding
Eclipse iceoryx inter-process-communication (IPC) middleware C-Language Binding
|
|
1 | 2024-06-08 | ortools_vendor |
Wrapper around ortools, it provides a fixed CMake module and an ExternalProject build of it.
Wrapper around ortools, it provides a fixed CMake module and an ExternalProject build of it.
|
|
2 | 2024-06-07 | rc_genicam_driver |
Driver for rc_visard and rc_cube from Roboception GmbH
Driver for rc_visard and rc_cube from Roboception GmbH
|
|
2 | 2024-06-06 | sophus |
C++ implementation of Lie Groups using Eigen.
C++ implementation of Lie Groups using Eigen.
|
|
1 | 2024-06-06 | message_tf_frame_transformer |
Transforms messages of arbitrary type to a different frame using tf2::doTransform
Transforms messages of arbitrary type to a different frame using tf2::doTransform
|
|
1 | 2024-06-05 | irobot_create_msgs |
Package containing action, message, and service definitions used by the iRobot(R) Create(R) platform
Package containing action, message, and service definitions used by the iRobot(R) Create(R) platform
|
|
1 | 2024-06-04 | heaphook |
Replace all the dynamic heap allocation functions by LD_PRELOAD
Replace all the dynamic heap allocation functions by LD_PRELOAD
|
|
2 | 2024-06-04 | aruco_opencv_msgs |
Message definitions for aruco_opencv package.
Message definitions for aruco_opencv package.
|
|
2 | 2024-06-04 | aruco_opencv |
ArUco marker detection using aruco module from OpenCV libraries.
ArUco marker detection using aruco module from OpenCV libraries.
|
|
1 | 2024-06-01 | event_camera_py |
Python access for event_camera_msgs.
Python access for event_camera_msgs.
|
|
1 | 2024-05-30 | libcaer_driver |
ROS2 driver for event base sensors using libcaer
ROS2 driver for event base sensors using libcaer
|
|
1 | 2024-05-30 | event_camera_msgs |
messages for event based cameras
messages for event based cameras
|
|
1 | 2024-05-27 | libnabo |
libnabo is a fast K Nearest Neighbour library for low-dimensional spaces.
libnabo is a fast K Nearest Neighbour library for low-dimensional spaces.
|
|
1 | 2024-05-25 | steering_functions |
The steering_functions package
The steering_functions package
|
|
1 | 2024-05-25 | nmea_msgs |
The nmea_msgs package contains messages related to data in the NMEA format.
The nmea_msgs package contains messages related to data in the NMEA format.
|
|
1 | 2024-05-24 | nonpersistent_voxel_layer |
include
This package provides an implementation of a 3D costmap that takes in sensor
data from the world, builds a 3D occupancy grid of the data for only one iteration.
include
This package provides an implementation of a 3D costmap that takes in sensor
data from the world, builds a 3D occupancy grid of the data for only one iteration.
|
|
1 | 2024-05-24 | catch_ros2 |
Catch2 testing framework for ROS 2 unit and integration tests.
Catch2 testing framework for ROS 2 unit and integration tests.
|
|
2 | 2024-05-20 | visualization_msgs |
A package containing some visualization and interaction related message definitions.
A package containing some visualization and interaction related message definitions.
|
|
2 | 2024-05-20 | trajectory_msgs |
A package containing some robot trajectory message definitions.
A package containing some robot trajectory message definitions.
|
|
2 | 2024-05-20 | stereo_msgs |
A package containing some stereo camera related message definitions.
A package containing some stereo camera related message definitions.
|
|
2 | 2024-05-20 | std_srvs |
A package containing some standard service definitions.
A package containing some standard service definitions.
|
|
2 | 2024-05-20 | std_msgs |
A package containing some standard message definitions.
A package containing some standard message definitions.
|
|
2 | 2024-05-20 | shape_msgs |
A package containing some message definitions which describe geometric shapes.
A package containing some message definitions which describe geometric shapes.
|
|
1 | 2024-05-20 | sensor_msgs_py |
A package for easy creation and reading of PointCloud2 messages in Python.
A package for easy creation and reading of PointCloud2 messages in Python.
|
|
2 | 2024-05-20 | sensor_msgs |
A package containing some sensor data related message and service definitions.
A package containing some sensor data related message and service definitions.
|
|
2 | 2024-05-20 | nav_msgs |
A package containing some navigation related message and service definitions.
A package containing some navigation related message and service definitions.
|
|
2 | 2024-05-20 | geometry_msgs |
A package containing some geometry related message definitions.
A package containing some geometry related message definitions.
|
|
2 | 2024-05-20 | diagnostic_msgs |
A package containing some diagnostics related message and service definitions.
A package containing some diagnostics related message and service definitions.
|
|
1 | 2024-05-20 | common_interfaces |
common_interfaces contains messages and services that are widely used by other ROS packages.
common_interfaces contains messages and services that are widely used by other ROS packages.
|
|
2 | 2024-05-20 | actionlib_msgs |
A package containing some message definitions used in the implementation of ROS 1 actions.
A package containing some message definitions used in the implementation of ROS 1 actions.
|
|
1 | 2024-05-18 | libcaer_vendor |
Wrapper around libcaer library
Wrapper around libcaer library
|
|
1 | 2024-05-17 | slider_publisher |
This packages proposes a slider-based publisher node similar to the joint_state_publisher, but that can publish any type of message or call services.
This packages proposes a slider-based publisher node similar to the joint_state_publisher, but that can publish any type of message or call services.
|
|
1 | 2024-05-14 | spatio_temporal_voxel_layer |
The spatio-temporal 3D obstacle costmap package
The spatio-temporal 3D obstacle costmap package
|
|
1 | 2024-05-14 | openvdb_vendor |
Wrapper around OpenVDB, if not found on the system, will compile from source
Wrapper around OpenVDB, if not found on the system, will compile from source
|
|
1 | 2024-05-12 | apriltag_draw |
ROS package for drawing apriltags on image
ROS package for drawing apriltags on image
|
|
1 | 2024-05-12 | apriltag_detector_umich |
ROS package for apriltag detection with the UMich detector
ROS package for apriltag detection with the UMich detector
|
|
1 | 2024-05-12 | apriltag_detector_mit |
ROS package for apriltag detection with MIT detector
ROS package for apriltag detection with MIT detector
|
|
1 | 2024-05-12 | apriltag_detector |
ROS2 package for apriltag detection
ROS2 package for apriltag detection
|
|
1 | 2024-05-11 | sros2_cmake |
CMake macros to configure security
CMake macros to configure security
|
|
1 | 2024-05-11 | sros2 |
Command line tools for managing SROS2 keys
Command line tools for managing SROS2 keys
|
|
1 | 2024-05-09 | plotjuggler_ros |
PlotJuggler plugin for ROS
PlotJuggler plugin for ROS
|
|
1 | 2024-05-09 | aruco_ros |
The ARUCO Library has been developed by the Ava group of the Univeristy of Cordoba(Spain).
It provides real-time marker based 3D pose estimation using AR markers.
The ARUCO Library has been developed by the Ava group of the Univeristy of Cordoba(Spain).
It provides real-time marker based 3D pose estimation using AR markers.
|
|
1 | 2024-05-09 | aruco_msgs |
The aruco_msgs package
The aruco_msgs package
|
|
1 | 2024-05-09 | aruco |
The ARUCO Library has been developed by the Ava group of the Univeristy of Cordoba(Spain).
It provides real-time marker based 3D pose estimation using AR markers.
The ARUCO Library has been developed by the Ava group of the Univeristy of Cordoba(Spain).
It provides real-time marker based 3D pose estimation using AR markers.
|
|
1 | 2024-05-03 | tinyspline_vendor |
The vendor package for tinyspline.
The vendor package for tinyspline.
|
|
1 | 2024-05-02 | phidgets_temperature |
Driver for the Phidgets Temperature devices
Driver for the Phidgets Temperature devices
|
|
1 | 2024-05-02 | phidgets_spatial |
Driver for the Phidgets Spatial 3/3/3 devices
Driver for the Phidgets Spatial 3/3/3 devices
|
|
1 | 2024-05-02 | phidgets_msgs |
Custom ROS messages for Phidgets drivers
Custom ROS messages for Phidgets drivers
|
|
1 | 2024-05-02 | phidgets_motors |
Driver for the Phidgets Motor devices
Driver for the Phidgets Motor devices
|
|
1 | 2024-05-02 | phidgets_magnetometer |
Driver for the Phidgets Magnetometer devices
Driver for the Phidgets Magnetometer devices
|
|
1 | 2024-05-02 | phidgets_ik |
Driver for the Phidgets InterfaceKit devices
Driver for the Phidgets InterfaceKit devices
|
|
1 | 2024-05-02 | phidgets_high_speed_encoder |
Driver for the Phidgets high speed encoder devices
Driver for the Phidgets high speed encoder devices
|
|
1 | 2024-05-02 | phidgets_gyroscope |
Driver for the Phidgets Gyroscope devices
Driver for the Phidgets Gyroscope devices
|
|
1 | 2024-05-02 | phidgets_drivers |
API and ROS drivers for Phidgets devices
API and ROS drivers for Phidgets devices
|
|
1 | 2024-05-02 | phidgets_digital_outputs |
Driver for the Phidgets Digital Output devices
Driver for the Phidgets Digital Output devices
|
|
1 | 2024-05-02 | phidgets_digital_inputs |
Driver for the Phidgets Digital Input devices
Driver for the Phidgets Digital Input devices
|
|
1 | 2024-05-02 | phidgets_api |
A C++ Wrapper for the Phidgets C API
A C++ Wrapper for the Phidgets C API
|
|
1 | 2024-05-02 | phidgets_analog_outputs |
Driver for the Phidgets Analog Output devices
Driver for the Phidgets Analog Output devices
|
|
1 | 2024-05-02 | phidgets_analog_inputs |
Driver for the Phidgets Analog Input devices
Driver for the Phidgets Analog Input devices
|
|
1 | 2024-05-02 | phidgets_accelerometer |
Driver for the Phidgets Accelerometer devices
Driver for the Phidgets Accelerometer devices
|
|
1 | 2024-05-02 | libphidget22 |
This package wraps the libphidget22 to use it as a ROS dependency
This package wraps the libphidget22 to use it as a ROS dependency
|
|
1 | 2024-04-30 | v4l2_camera |
A ROS 2 camera driver using Video4Linux2
A ROS 2 camera driver using Video4Linux2
|
|
2 | 2024-04-30 | naoqi_driver |
Driver module between Aldebaran's NAOqiOS and ROS2. It publishes all sensor and actuator data as well as basic diagnostic for battery, temperature. It subscribes also to RVIZ simple goal and cmd_vel for teleop.
Driver module between Aldebaran's NAOqiOS and ROS2. It publishes all sensor and actuator data as well as basic diagnostic for battery, temperature. It subscribes also to RVIZ simple goal and cmd_vel for teleop.
|
|
1 | 2024-04-28 | zbar_ros |
Lightweight ROS wrapper for Zbar barcode/qrcode reader library (http://zbar.sourceforge
.net/)
Lightweight ROS wrapper for Zbar barcode/qrcode reader library (http://zbar.sourceforge
.net/)
|
|
2 | 2024-04-26 | rclpy_message_converter_msgs |
Messages for rclpy_message_converter
Messages for rclpy_message_converter
|
|
2 | 2024-04-26 | rclpy_message_converter |
Converts between Python dictionaries and JSON to rclpy messages.
Converts between Python dictionaries and JSON to rclpy messages.
|
|
1 | 2024-04-24 | dynamixel_hardware |
ros2_control hardware for ROBOTIS Dynamixel
ros2_control hardware for ROBOTIS Dynamixel
|
|
1 | 2024-04-23 | pcl_msgs |
Package containing PCL (Point Cloud Library)-related ROS messages.
Package containing PCL (Point Cloud Library)-related ROS messages.
|
|
1 | 2024-04-22 | apriltag_mit |
ROS2 package wrapper for the MIT apriltag detector
ROS2 package wrapper for the MIT apriltag detector
|
|
2 | 2024-04-21 | rcgcrd_spl_4_conversion |
Converts RoboCup SPL GameController Return Data V4 between ROS msg and UDP raw bytes
Converts RoboCup SPL GameController Return Data V4 between ROS msg and UDP raw bytes
|
|
2 | 2024-04-21 | rcgcrd_spl_4 |
RoboCup SPL GameController Return Data V4 ROS msg
RoboCup SPL GameController Return Data V4 ROS msg
|
|
2 | 2024-04-21 | rcgcd_spl_14_conversion |
Converts RoboCup SPL GameController Data V14 between ROS msg and UDP raw bytes
Converts RoboCup SPL GameController Data V14 between ROS msg and UDP raw bytes
|
|
2 | 2024-04-21 | rcgcd_spl_14 |
RoboCup SPL GameController Data V14 ROS msg
RoboCup SPL GameController Data V14 ROS msg
|
|
2 | 2024-04-21 | nao_meshes |
ROS2 Meshes for the NAO robot
ROS2 Meshes for the NAO robot
|
|
1 | 2024-04-21 | gc_spl_interfaces |
RoboCup SPL GameController Data ROS msg
RoboCup SPL GameController Data ROS msg
|
|
2 | 2024-04-21 | gc_spl_2022 |
GameController-Robot communication in RoboCup SPL at RoboCup2022
GameController-Robot communication in RoboCup SPL at RoboCup2022
|
|
1 | 2024-04-21 | gc_spl |
GameController-Robot communication in RoboCup SPL
GameController-Robot communication in RoboCup SPL
|
|
1 | 2024-04-21 | game_controller_spl_interfaces |
RoboCup SPL GameController Data ROS msg
RoboCup SPL GameController Data ROS msg
|
|
1 | 2024-04-21 | game_controller_spl |
GameController-Robot communication in RoboCup SPL
GameController-Robot communication in RoboCup SPL
|
|
1 | 2024-04-20 | nao_sensor_msgs |
Package defining sensor msgs to be received from NAO robot.
Package defining sensor msgs to be received from NAO robot.
|
|
1 | 2024-04-20 | nao_command_msgs |
Package defining command msgs to be sent to NAO robot.
Package defining command msgs to be sent to NAO robot.
|
|
1 | 2024-04-20 | nao_button_sim |
Allows simulating button presses through command line interface
Allows simulating button presses through command line interface
|
|
1 | 2024-04-17 | rqt_image_view |
rqt_image_view provides a GUI plugin for displaying images using image_transport.
rqt_image_view provides a GUI plugin for displaying images using image_transport.
|
|
2 | 2024-04-17 | 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 | 2024-04-17 | cartographer_ros_msgs |
ROS messages for the cartographer_ros package.
ROS messages for the cartographer_ros package.
|
|
2 | 2024-04-17 | 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.
|
|
1 | 2024-04-15 | ffmpeg_image_transport_tools |
tools for processing ffmpeg_image_transport_msgs
tools for processing ffmpeg_image_transport_msgs
|
|
1 | 2024-04-14 | splsm_8_conversion |
Converts Standard Platform League Standard Message V8 between ROS msg and UDP raw bytes
Converts Standard Platform League Standard Message V8 between ROS msg and UDP raw bytes
|
|
1 | 2024-04-14 | splsm_8 |
RoboCup Standard Platform League Standard Message V8 ROS msg
RoboCup Standard Platform League Standard Message V8 ROS msg
|
|
1 | 2024-04-14 | splsm_7_conversion |
Converts Standard Platform League Standard Message V7 between ROS msg and UDP raw bytes
Converts Standard Platform League Standard Message V7 between ROS msg and UDP raw bytes
|
|
1 | 2024-04-14 | splsm_7 |
RoboCup Standard Platform League Standard Message V7 ROS msg
RoboCup Standard Platform League Standard Message V7 ROS msg
|
|
1 | 2024-04-14 | r2r_spl_test_interfaces |
Messages for testing r2r_spl
Messages for testing r2r_spl
|
|
1 | 2024-04-14 | r2r_spl_8 |
Robot-To-Robot communication in RoboCup SPL
Robot-To-Robot communication in RoboCup SPL
|
|
1 | 2024-04-14 | r2r_spl_7 |
Robot-To-Robot communication in RoboCup SPL using SPLSM V7
Robot-To-Robot communication in RoboCup SPL using SPLSM V7
|
|
1 | 2024-04-14 | r2r_spl |
Robot-to-Robot Communication in RoboCup Standard Platform League
Robot-to-Robot Communication in RoboCup Standard Platform League
|
|
2 | 2024-04-13 | vision_opencv |
Packages for interfacing ROS2 with OpenCV, a library of programming functions for real time computer vision.
Packages for interfacing ROS2 with OpenCV, a library of programming functions for real time computer vision.
|
|
2 | 2024-04-13 | opencv_tests |
OpenCV tests for the Python and C++ implementations of CvBridge with Image message in ROS2.
OpenCV tests for the Python and C++ implementations of CvBridge with Image message in ROS2.
|
|
1 | 2024-04-13 | nao_lola |
Packages that allow communicating with the NAO’s Lola middle-ware.
Packages that allow communicating with the NAO’s Lola middle-ware.
|
|
2 | 2024-04-13 | image_geometry |
`image_geometry` contains C++ and Python libraries for interpreting images
geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo
messages with OpenCV functions such as image rectification, much as cv_bridge
interfaces ROS sensor_msgs/Image with OpenCV data types.
`image_geometry` contains C++ and Python libraries for interpreting images
geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo
messages with OpenCV functions such as image rectification, much as cv_bridge
interfaces ROS sensor_msgs/Image with OpenCV data types.
|
|
1 | 2024-04-13 | cv_bridge |
This contains CvBridge, which converts between ROS2
Image messages and OpenCV images.
This contains CvBridge, which converts between ROS2
Image messages and OpenCV images.
|
|
1 | 2024-04-04 | rclcpp_cascade_lifecycle |
Provides a mechanism to make trees of lifecycle nodes to propagate state changes
Provides a mechanism to make trees of lifecycle nodes to propagate state changes
|
|
1 | 2024-04-04 | geographic_msgs |
ROS messages for Geographic Information Systems.
ROS messages for Geographic Information Systems.
|
Packages
Name | Description | |||
---|---|---|---|---|
1 | 2023-11-22 | pilz_testutils |
This package contains testing utilities used by Pilz packages.
This package contains testing utilities used by Pilz packages.
|
|
1 | 2023-11-22 | pilz_store_positions |
Allows to store poses during teach-in.
Allows to store poses during teach-in.
|
|
1 | 2023-11-22 | pilz_status_indicator_rqt |
Showing information about operation mode, status and speed override of the robot.
Showing information about operation mode, status and speed override of the robot.
|
|
1 | 2023-11-22 | pilz_robots |
The metapackage
The metapackage
|
|
1 | 2023-11-22 | pilz_robot_programming |
An Easy to use API to execute standard industrial robot commands like Ptp, Lin, Circ and Sequence using Moveit.
An Easy to use API to execute standard industrial robot commands like Ptp, Lin, Circ and Sequence using Moveit.
|
|
1 | 2023-11-22 | pilz_msgs |
The pilz_msgs package
The pilz_msgs package
|
|
1 | 2023-11-22 | pilz_industrial_motion_testutils |
Helper scripts and functionality to test industrial motion generation
Helper scripts and functionality to test industrial motion generation
|
|
1 | 2023-11-22 | pilz_industrial_motion |
The pilz_industrial_motion package
The pilz_industrial_motion package
|
|
1 | 2023-11-22 | pilz_extensions |
The pilz_extensions package. Here are classes extending the functionality of other packages.
On the long run these extensions should become pull requests on the respective packages.
The pilz_extensions package. Here are classes extending the functionality of other packages.
On the long run these extensions should become pull requests on the respective packages.
|
|
1 | 2023-11-22 | pilz_control |
This package provides a specialized joint_trajectory_controller that can be moved into holding state via service call.
No further trajectories will be accepted/followed in this state.
This package provides a specialized joint_trajectory_controller that can be moved into holding state via service call.
No further trajectories will be accepted/followed in this state.
|
|
2 | 2023-11-13 | velocity_controllers |
velocity_controllers
velocity_controllers
|
|
2 | 2023-11-13 | rqt_joint_trajectory_controller |
Graphical frontend for interacting with joint_trajectory_controller instances.
Graphical frontend for interacting with joint_trajectory_controller instances.
|
|
1 | 2023-11-13 | ros_controllers |
Library of ros controllers
Library of ros controllers
|
|
2 | 2023-11-13 | position_controllers |
position_controllers
position_controllers
|
|
3 | 2023-11-13 | 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 | 2023-11-13 | joint_state_controller |
Controller to publish joint state
Controller to publish joint state
|
|
1 | 2023-11-13 | imu_sensor_controller |
Controller to publish state of IMU sensors
Controller to publish state of IMU sensors
|
|
1 | 2023-11-13 | gripper_action_controller |
The gripper_action_controller package
The gripper_action_controller package
|
|
1 | 2023-11-13 | four_wheel_steering_controller |
Controller for a four wheel steering mobile base.
Controller for a four wheel steering mobile base.
|
|
2 | 2023-11-13 | forward_command_controller |
forward_command_controller
forward_command_controller
|
|
1 | 2023-11-13 | force_torque_sensor_controller |
Controller to publish state of force-torque sensors
Controller to publish state of force-torque sensors
|
|
2 | 2023-11-13 | effort_controllers |
effort_controllers
effort_controllers
|
|
2 | 2023-11-13 | diff_drive_controller |
Controller for a differential drive mobile base.
Controller for a differential drive mobile base.
|
|
2 | 2023-11-13 | ackermann_steering_controller |
Controller for a steer drive mobile base.
Controller for a steer drive mobile base.
|
|
1 | 2023-11-03 | ros_numpy |
A collection of conversion function for extracting numpy arrays from messages
A collection of conversion function for extracting numpy arrays from messages
|
|
2 | 2023-10-31 | leo_viz |
Visualization launch files and RViz configurations for Leo Rover
Visualization launch files and RViz configurations for Leo Rover
|
|
2 | 2023-10-31 | leo_desktop |
Metapackage of software for operating Leo Rover from ROS desktop
Metapackage of software for operating Leo Rover from ROS desktop
|
|
2 | 2023-10-27 | transmission_interface |
Transmission Interface.
Transmission Interface.
|
|
2 | 2023-10-27 | rqt_controller_manager |
Graphical frontend for interacting with the controller manager.
Graphical frontend for interacting with the controller manager.
|
|
1 | 2023-10-27 | 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 | 2023-10-27 | joint_limits_interface |
Interface for enforcing joint limits.
Interface for enforcing joint limits.
|
|
2 | 2023-10-27 | hardware_interface |
Hardware Interface base class.
Hardware Interface base class.
|
|
1 | 2023-10-27 | controller_manager_tests |
Tests for the controller manager.
Tests for the controller manager.
|
|
2 | 2023-10-27 | controller_manager_msgs |
Messages and services for the controller manager.
Messages and services for the controller manager.
|
|
2 | 2023-10-27 | controller_manager |
The controller manager.
The controller manager.
|
|
2 | 2023-10-27 | controller_interface |
Interface base class for controllers.
Interface base class for controllers.
|
|
1 | 2023-10-27 | combined_robot_hw_tests |
Tests for the combined Robot HW class.
Tests for the combined Robot HW class.
|
|
1 | 2023-10-27 | combined_robot_hw |
Combined Robot HW class.
Combined Robot HW class.
|
|
1 | 2023-10-25 | skyway |
Package for using SkyWay from ROS
Package for using SkyWay from ROS
|
|
1 | 2023-10-25 | openni2_launch |
Launch files to start the openni2_camera drivers using rgbd_launch.
Launch files to start the openni2_camera drivers using rgbd_launch.
|
|
1 | 2023-10-25 | openni2_camera |
Drivers for the Asus Xtion and Primesense Devices. For using a kinect
with ROS, try the
Drivers for the Asus Xtion and Primesense Devices. For using a kinect
with ROS, try the
|
|
1 | 2023-10-25 | dynamic-graph-python |
Dynamic graph library Python bindings
Dynamic graph library Python bindings
|
|
1 | 2023-10-24 | sot-core |
Hierarchical task solver plug-in for dynamic-graph
Hierarchical task solver plug-in for dynamic-graph
|
|
1 | 2023-10-19 | khi_rs_ikfast_plugin |
The khi_rs_ikfast_plugin package
The khi_rs_ikfast_plugin package
|
|
1 | 2023-10-19 | khi_rs_gazebo |
The khi_rs_gazebo package
The khi_rs_gazebo package
|
|
1 | 2023-10-19 | khi_rs_description |
The khi_rs_description package
The khi_rs_description package
|
|
1 | 2023-10-19 | khi_rs080n_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs080n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs080n with the MoveIt! Motion Planning Framework
|
|
1 | 2023-10-19 | khi_rs030n_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs030n with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs030n with the MoveIt Motion Planning Framework
|
|
1 | 2023-10-19 | khi_rs025n_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs025n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs025n with the MoveIt! Motion Planning Framework
|
|
1 | 2023-10-19 | khi_rs020n_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs020n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs020n with the MoveIt! Motion Planning Framework
|
|
1 | 2023-10-19 | khi_rs013n_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs013n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs013n with the MoveIt! Motion Planning Framework
|
|
1 | 2023-10-19 | khi_rs007n_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs007n with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs007n with the MoveIt! Motion Planning Framework
|
|
1 | 2023-10-19 | khi_rs007l_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_rs007l with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_rs007l with the MoveIt! Motion Planning Framework
|
|
1 | 2023-10-19 | khi_robot_test |
Test package for khi_robot
Test package for khi_robot
|
|
1 | 2023-10-19 | khi_robot_msgs |
This package contains KHI ROS robot msgs
This package contains KHI ROS robot msgs
|
|
1 | 2023-10-19 | khi_robot_control |
ROS KHI robot controller package based on ros_control
ROS KHI robot controller package based on ros_control
|
|
1 | 2023-10-19 | khi_robot_bringup |
Package contains bringup scripts/config/tools for KHI Robot
Package contains bringup scripts/config/tools for KHI Robot
|
|
1 | 2023-10-19 | khi_robot |
Meta package for khi_robot
Meta package for khi_robot
|
|
1 | 2023-10-19 | khi_duaro_moveit_config |
An automatically generated package with all the configuration and launch files for using the khi_duaro with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the khi_duaro with the MoveIt! Motion Planning Framework
|
|
1 | 2023-10-19 | khi_duaro_ikfast_plugin |
The khi_duaro_ikfast_plugin package
The khi_duaro_ikfast_plugin package
|
|
1 | 2023-10-19 | khi_duaro_gazebo |
The khi_duaro_gazebo package
The khi_duaro_gazebo package
|
|
1 | 2023-10-19 | khi_duaro_description |
The khi_duaro_description package
The khi_duaro_description package
|
|
1 | 2023-10-18 | openslam_gmapping |
The catkinized verseion of openslam_gmapping package (https://github.com/OpenSLAM-org/openslam_gmapping/tree/79ef0b0e6d9a12d6390ae64c4c00d37d776abefb)
The catkinized verseion of openslam_gmapping package (https://github.com/OpenSLAM-org/openslam_gmapping/tree/79ef0b0e6d9a12d6390ae64c4c00d37d776abefb)
|
|
2 | 2023-10-17 | scan_tools |
Laser scan processing tools.
Laser scan processing tools.
|
|
2 | 2023-10-17 | scan_to_cloud_converter |
Converts LaserScan to PointCloud messages.
Converts LaserScan to PointCloud messages.
|
|
2 | 2023-10-17 | polar_scan_matcher |
|
|
2 | 2023-10-17 | ncd_parser |
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
|
|
2 | 2023-10-17 | laser_scan_splitter |
The laser_scan_splitter takes in a LaserScan message and splits it into a number of other LaserScan messages. Each of the resulting laser scans can be assigned an arbitrary coordinate frame, and is published on a separate topic.
The laser_scan_splitter takes in a LaserScan message and splits it into a number of other LaserScan messages. Each of the resulting laser scans can be assigned an arbitrary coordinate frame, and is published on a separate topic.
|
|
2 | 2023-10-17 | laser_scan_sparsifier |
The laser_scan_sparsifier takes in a LaserScan message and sparsifies it.
The laser_scan_sparsifier takes in a LaserScan message and sparsifies it.
|
|
2 | 2023-10-17 | laser_scan_matcher |
|
|
2 | 2023-10-17 | 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 | 2023-10-12 | rqt_console |
rqt_console provides a GUI plugin for displaying and filtering ROS messages.
rqt_console provides a GUI plugin for displaying and filtering ROS messages.
|
|
1 | 2023-10-11 | kobuki_testsuite |
Kobuki test suite: this package provides tools to thoroughly test Kobuki's hardware.
Kobuki test suite: this package provides tools to thoroughly test Kobuki's hardware.
|
|
1 | 2023-10-11 | kobuki_safety_controller |
A controller ensuring the safe operation of Kobuki.
The SafetyController keeps track of bumper, cliff and wheel drop events. In case of the first two,
Kobuki is commanded to move back. In the latter case, Kobuki is stopped.
This controller can be enabled/disabled.
The safety states (bumper pressed etc.) can be reset. WARNING: Dangerous!
A controller ensuring the safe operation of Kobuki.
The SafetyController keeps track of bumper, cliff and wheel drop events. In case of the first two,
Kobuki is commanded to move back. In the latter case, Kobuki is stopped.
This controller can be enabled/disabled.
The safety states (bumper pressed etc.) can be reset. WARNING: Dangerous!
|
|
1 | 2023-10-11 | kobuki_rviz_launchers |
The kobuki_rviz_launchers package
The kobuki_rviz_launchers package
|
|
1 | 2023-10-11 | kobuki_rapps |
Robot apps for Kobuki
Robot apps for Kobuki
|
|
1 | 2023-10-11 | kobuki_random_walker |
Random walker app for Kobuki
Random walker app for Kobuki
|
|
1 | 2023-10-11 | kobuki_qtestsuite |
An rqt plugin that provides a graphical, interactive testsuite for Kobuki.
An rqt plugin that provides a graphical, interactive testsuite for Kobuki.
|
|
1 | 2023-10-11 | kobuki_node |
ROS nodelet for Kobuki: ROS wrapper for the Kobuki driver.
ROS nodelet for Kobuki: ROS wrapper for the Kobuki driver.
|
|
1 | 2023-10-11 | kobuki_keyop |
Keyboard teleoperation for Kobuki: relays commands from a keyboard to Kobuki.
Keyboard teleoperation for Kobuki: relays commands from a keyboard to Kobuki.
|
|
1 | 2023-10-11 | kobuki_gazebo_plugins |
Kobuki-specific ROS plugins for Gazebo
Kobuki-specific ROS plugins for Gazebo
|
|
1 | 2023-10-11 | kobuki_gazebo |
Kobuki simulation for Gazebo
Kobuki simulation for Gazebo
|
|
1 | 2023-10-11 | kobuki_desktop |
Visualisation and simulation tools for Kobuki
Visualisation and simulation tools for Kobuki
|
|
1 | 2023-10-11 | kobuki_description |
Description of the Kobuki model.
Provides the model description of Kobuki for simulation and visualisation. The files in this
package are parsed and used by a variety of other components. Most users will not interact directly
with this package.
WARNING: This package is disabled because it cannot be catkinized by now, as xacro dependency is not
catkin still. In the interim we use a unary pre-catkin stack named kobuki_description.
Description of the Kobuki model.
Provides the model description of Kobuki for simulation and visualisation. The files in this
package are parsed and used by a variety of other components. Most users will not interact directly
with this package.
WARNING: This package is disabled because it cannot be catkinized by now, as xacro dependency is not
catkin still. In the interim we use a unary pre-catkin stack named kobuki_description.
|
|
1 | 2023-10-11 | kobuki_dashboard |
The Kobuki dashboard is a RQT-based plug-in for visualising data from Kobuki and giving easy access
to basic functionalities.
The Kobuki dashboard is a RQT-based plug-in for visualising data from Kobuki and giving easy access
to basic functionalities.
|
|
1 | 2023-10-11 | kobuki_controller_tutorial |
Code for the Kobuki controller tutorial.
Code for the Kobuki controller tutorial.
|
|
1 | 2023-10-11 | kobuki_capabilities |
Kobuki's capabilities
Kobuki's capabilities
|
|
1 | 2023-10-11 | kobuki_bumper2pc |
Bumper/cliff to pointcloud nodelet:
Publish bumpers and cliff sensors events as points in a pointcloud, so navistack can use them
for poor-man navigation. Implemented as a nodelet intended to run together with kobuki_node.
Bumper/cliff to pointcloud nodelet:
Publish bumpers and cliff sensors events as points in a pointcloud, so navistack can use them
for poor-man navigation. Implemented as a nodelet intended to run together with kobuki_node.
|
|
1 | 2023-10-11 | kobuki_auto_docking |
Automatic docking for Kobuki:
Users owning a docking station for Kobuki can use this tool to let Kobuki find its nest autonomously.
Automatic docking for Kobuki:
Users owning a docking station for Kobuki can use this tool to let Kobuki find its nest autonomously.
|
|
1 | 2023-10-11 | kobuki |
Software for Kobuki, Yujin Robot's mobile research base.
Software for Kobuki, Yujin Robot's mobile research base.
|
|
1 | 2023-10-04 | rqt_robot_steering |
rqt_robot_steering provides a GUI plugin for steering a robot using Twist messages.
rqt_robot_steering provides a GUI plugin for steering a robot using Twist messages.
|
|
1 | 2023-10-04 | rqt_publisher |
rqt_publisher provides a GUI plugin for publishing arbitrary messages with fixed or computed field values.
rqt_publisher provides a GUI plugin for publishing arbitrary messages with fixed or computed field values.
|
|
1 | 2023-10-04 | rqt_dep |
rqt_dep provides a GUI plugin for visualizing the ROS dependency graph.
rqt_dep provides a GUI plugin for visualizing the ROS dependency graph.
|
|
1 | 2023-10-02 | rqt_tf_tree |
rqt_tf_tree provides a GUI plugin for visualizing the ROS TF frame tree.
rqt_tf_tree provides a GUI plugin for visualizing the ROS TF frame tree.
|
|
1 | 2023-10-02 | rqt_runtime_monitor |
rqt_runtime_monitor provides a GUI plugin viewing DiagnosticsArray messages.
rqt_runtime_monitor provides a GUI plugin viewing DiagnosticsArray messages.
|
|
1 | 2023-10-02 | rqt_logger_level |
rqt_logger_level provides a GUI plugin for configuring the logger level of ROS nodes.
rqt_logger_level provides a GUI plugin for configuring the logger level of ROS nodes.
|
|
1 | 2023-09-29 | novatel_gps_msgs |
Messages for proprietary (non-NMEA) sentences from Novatel GPS receivers.
Messages for proprietary (non-NMEA) sentences from Novatel GPS receivers.
|
|
1 | 2023-09-29 | novatel_gps_driver |
Driver for NovAtel receivers
Driver for NovAtel receivers
|
|
1 | 2023-09-29 | crane_x7_msgs |
The crane_x7_msgs package
The crane_x7_msgs package
|
|
1 | 2023-09-29 | crane_x7_moveit_config |
An automatically generated package with all the configuration and launch files for using the crane_x7 with the MoveIt! Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the crane_x7 with the MoveIt! Motion Planning Framework
|
|
1 | 2023-09-29 | crane_x7_gazebo |
The crane_x7_gazebo package
The crane_x7_gazebo package
|
|
1 | 2023-09-29 | crane_x7_examples |
examples of CRANE-X7 ROS package
examples of CRANE-X7 ROS package
|
|
1 | 2023-09-29 | crane_x7_control |
The CRANE-X7 control package
The CRANE-X7 control package
|
|
1 | 2023-09-29 | crane_x7_bringup |
The CRANE-X7 bringup package
The CRANE-X7 bringup package
|
|
1 | 2023-09-29 | crane_x7 |
ROS package suite of CRANE-X7
ROS package suite of CRANE-X7
|
|
1 | 2023-09-28 | dockeros |
Simply running ros nodes in docker containers on remote robots.
Simply running ros nodes in docker containers on remote robots.
|
|
1 | 2023-09-27 | 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 | 2023-09-27 | rosbridge_server |
A WebSocket interface to rosbridge.
A WebSocket interface to rosbridge.
|
|
1 | 2023-09-27 | rosbridge_msgs |
Package containing message files
Package containing message files
|
|
1 | 2023-09-27 | rosbridge_library |
The core rosbridge package, responsible for interpreting JSON and performing
the appropriate ROS action, like subscribe, publish, call service, and
interact with params.
The core rosbridge package, responsible for interpreting JSON and performing
the appropriate ROS action, like subscribe, publish, call service, and
interact with params.
|
|
1 | 2023-09-27 | 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 | 2023-09-22 | omronsentech_camera |
omronsentech_camera package contains a basic functionality to access OMRON SENTECH Camera. This package requires installation of SentechSDK.
omronsentech_camera package contains a basic functionality to access OMRON SENTECH Camera. This package requires installation of SentechSDK.
|
|
1 | 2023-09-21 | aruco_ros |
The ARUCO Library has been developed by the Ava group of the Univeristy of Cordoba(Spain).
It provides real-time marker based 3D pose estimation using AR markers.
The ARUCO Library has been developed by the Ava group of the Univeristy of Cordoba(Spain).
It provides real-time marker based 3D pose estimation using AR markers.
|
|
1 | 2023-09-21 | aruco_msgs |
The aruco_msgs package
The aruco_msgs package
|
|
1 | 2023-09-21 | aruco |
The ARUCO Library has been developed by the Ava group of the Univeristy of Cordoba(Spain).
It provides real-time marker based 3D pose estimation using AR markers.
The ARUCO Library has been developed by the Ava group of the Univeristy of Cordoba(Spain).
It provides real-time marker based 3D pose estimation using AR markers.
|
|
1 | 2023-09-20 | swri_console |
A rosout GUI viewer developed at Southwest Research Insititute as an
alternative to rqt_console.
A rosout GUI viewer developed at Southwest Research Insititute as an
alternative to rqt_console.
|
|
1 | 2023-09-20 | px4_msgs |
Package with the ROS-equivalent of PX4 uORB msgs
Package with the ROS-equivalent of PX4 uORB msgs
|
|
1 | 2023-09-15 | ifopt |
An
An
|
|
1 | 2023-09-03 | nmea_msgs |
The nmea_msgs package contains messages related to data in the NMEA format.
The nmea_msgs package contains messages related to data in the NMEA format.
|
|
1 | 2023-08-29 | robot_calibration_msgs |
Messages for calibrating a robot
Messages for calibrating a robot
|
|
1 | 2023-08-29 | robot_calibration |
Calibrate a Robot
Calibrate a Robot
|
|
1 | 2023-08-29 | openzen_sensor |
ROS driver for LP-Research inertial measurement units and satellite navigation senors
ROS driver for LP-Research inertial measurement units and satellite navigation senors
|
|
1 | 2023-08-29 | code_coverage |
CMake configuration to run coverage
CMake configuration to run coverage
|
|
1 | 2023-08-25 | cras_msgs |
Common messages used by CRAS
Common messages used by CRAS
|
|
1 | 2023-08-04 | rtmros_common |
A package suite that provides all the capabilities for
the ROS users to connect to the robots that run on
A package suite that provides all the capabilities for
the ROS users to connect to the robots that run on
|
|
1 | 2023-08-04 | rtmbuild |
Build scripts for OpenRTM and OpenHRP
Build scripts for OpenRTM and OpenHRP
|
|
1 | 2023-08-04 | rosnode_rtc |
This package gives transparency between RTM and ROS.
rtmros-data-bridge.py is a RT-Component for dataport/topic.
This automatically convert ROS/topic into RTM/dataport.
This package gives transparency between RTM and ROS.
rtmros-data-bridge.py is a RT-Component for dataport/topic.
This automatically convert ROS/topic into RTM/dataport.
|
|
1 | 2023-08-04 | openrtm_tools |
The openrtm_tools package
The openrtm_tools package
|
|
1 | 2023-08-04 | openrtm_ros_bridge |
openrtm_ros_bridge package provides basic functionalities to bind
two robotics framework:
openrtm_ros_bridge package provides basic functionalities to bind
two robotics framework:
|
|
1 | 2023-08-04 | hrpsys_tools |
The hrpsys_tools package
The hrpsys_tools package
|
|
1 | 2023-08-04 | hrpsys_ros_bridge |
hrpsys_ros_bridge package provides basic functionalities to bind
hrpsys_ros_bridge package provides basic functionalities to bind
|
|
1 | 2023-07-28 | sot-tools |
Miscellanous entities for the stack of tasks
Miscellanous entities for the stack of tasks
|
|
1 | 2023-07-28 | sot-dynamic-pinocchio |
Pinocchio bindings for dynamic-graph
Pinocchio bindings for dynamic-graph
|
|
1 | 2023-07-10 | rosfmt |
fmt is an open-source formatting library for C++.
It can be used as a safe and fast alternative to (s)printf and IOStreams.
fmt is an open-source formatting library for C++.
It can be used as a safe and fast alternative to (s)printf and IOStreams.
|
|
1 | 2023-07-05 | hri |
A wrapper library around the ROS4HRI ROS topics
A wrapper library around the ROS4HRI ROS topics
|
|
1 | 2023-07-05 | fkie_potree_rviz_plugin |
Render large point clouds in rviz
Render large point clouds in rviz
|
|
1 | 2023-06-28 | smach_viewer |
The smach viewer is a GUI that shows the state of hierarchical
SMACH state machines. It can visualize the possible transitions
between states, as well as the currently active state and the
values of user data that is passed around between states. The
smach viewer uses the SMACH debugging interface based on
the
The smach viewer is a GUI that shows the state of hierarchical
SMACH state machines. It can visualize the possible transitions
between states, as well as the currently active state and the
values of user data that is passed around between states. The
smach viewer uses the SMACH debugging interface based on
the
|
|
1 | 2023-06-28 | industrial_robot_status_interface |
Exposes ROS-Industrial's RobotStatus info from hardware_interfaces for consumption by ros_control controllers.
Exposes ROS-Industrial's RobotStatus info from hardware_interfaces for consumption by ros_control controllers.
|
|
1 | 2023-06-28 | industrial_robot_status_controller |
A ros_control controller that reports robot status using the ROS-Industrial RobotStatus message.
A ros_control controller that reports robot status using the ROS-Industrial RobotStatus message.
|
|
1 | 2023-06-28 | executive_smach_visualization |
This metapackage depends on the SMACH visualization tools.
This metapackage depends on the SMACH visualization tools.
|
|
1 | 2023-06-22 | pr2eus_tutorials |
pr2eus_tutorials
pr2eus_tutorials
|
|
1 | 2023-06-22 | pr2eus_openrave |
pr2eus_openrave
pr2eus_openrave
|
|
1 | 2023-06-22 | pr2eus_moveit |
pr2eus_moveit
pr2eus_moveit
|
|
1 | 2023-06-22 | pr2eus_impedance |
pr2eus_impedance
pr2eus_impedance
|
|
1 | 2023-06-22 | pr2eus_armnavigation |
pr2eus_armnavigation
pr2eus_armnavigation
|
|
1 | 2023-06-22 | pr2eus |
pr2eus
pr2eus
|
|
1 | 2023-06-22 | jsk_pr2eus |
|
|
1 | 2023-06-20 | dynamic-graph-tutorial |
Dynamic graph tutorial
Dynamic graph tutorial
|
|
1 | 2023-06-19 | cras_imu_tools |
Tools for working with IMU data
Tools for working with IMU data
|
|
1 | 2023-06-18 | point_cloud_color |
Package for coloring point clouds using calibrated cameras.
Package for coloring point clouds using calibrated cameras.
|
|
2 | 2023-06-16 | point_cloud_transport_plugins |
Metapackage with common point_cloud_transport plugins
Metapackage with common point_cloud_transport plugins
|
|
2 | 2023-06-16 | point_cloud_transport |
Support for transporting PointCloud2 messages in compressed format and plugin interface for implementing additional PointCloud2 transports.
Support for transporting PointCloud2 messages in compressed format and plugin interface for implementing additional PointCloud2 transports.
|
|
2 | 2023-06-16 | draco_point_cloud_transport |
draco_point_cloud_transport provides a plugin to point_cloud_transport for sending point clouds
encoded with KD tree compression.
draco_point_cloud_transport provides a plugin to point_cloud_transport for sending point clouds
encoded with KD tree compression.
|
|
1 | 2023-06-13 | smach_ros |
The smach_ros package contains extensions for the SMACH library to
integrate it tightly with ROS. For example, SMACH-ROS can call
ROS services, listen to ROS topics, and integrate
with
The smach_ros package contains extensions for the SMACH library to
integrate it tightly with ROS. For example, SMACH-ROS can call
ROS services, listen to ROS topics, and integrate
with
|
|
1 | 2023-06-13 | smach_msgs |
this package contains a set of messages that are used by the introspection
interfaces for smach.
this package contains a set of messages that are used by the introspection
interfaces for smach.
|
|
1 | 2023-06-13 | smach |
SMACH is a task-level architecture for rapidly creating complex robot
behavior. At its core, SMACH is a ROS-independent Python library to build
hierarchical state machines. SMACH is a new library that takes advantage of
very old concepts in order to quickly create robust robot behavior with
maintainable and modular code.
SMACH is a task-level architecture for rapidly creating complex robot
behavior. At its core, SMACH is a ROS-independent Python library to build
hierarchical state machines. SMACH is a new library that takes advantage of
very old concepts in order to quickly create robust robot behavior with
maintainable and modular code.
|
|
1 | 2023-06-13 | executive_smach |
This metapackage depends on the SMACH library and ROS SMACH integration
packages.
This metapackage depends on the SMACH library and ROS SMACH integration
packages.
|
|
1 | 2023-06-11 | sensor_filters |
Simple sensor filter chain nodes and nodelets
Simple sensor filter chain nodes and nodelets
|
|
1 | 2023-06-01 | visualization_rwt |
|
|
1 | 2023-06-01 | rwt_utils_3rdparty |
The rwt_utils_3rdparty package
The rwt_utils_3rdparty package
|
|
1 | 2023-06-01 | rwt_steer |
The rwt_steer package
The rwt_steer package
|
|
1 | 2023-06-01 | rwt_speech_recognition |
The rwt_speech_recognition package
The rwt_speech_recognition package
|
|
1 | 2023-06-01 | rwt_robot_monitor |
The rwt_robot_monitor package
The rwt_robot_monitor package
|
|
1 | 2023-06-01 | rwt_plot |
rwt_plot
rwt_plot
|
|
1 | 2023-06-01 | rwt_nav |
The rwt_nav package
The rwt_nav package
|
|
1 | 2023-06-01 | rwt_moveit |
This package provides a web user interface of
This package provides a web user interface of
|
|
1 | 2023-06-01 | rwt_image_view |
The rwt_image_view package
The rwt_image_view package
|
|
1 | 2023-06-01 | rwt_app_chooser |
The simple web frontend for app_manager
The simple web frontend for app_manager
|
|
1 | 2023-05-29 | play_motion_msgs |
Messages, services and actions used by play_motion.
Messages, services and actions used by play_motion.
|
|
1 | 2023-05-29 | play_motion |
Plays a pre-recorded motion on a robot
Plays a pre-recorded motion on a robot
|
|
1 | 2023-05-29 | avt_vimba_camera |
Camera driver for Allied Vision Technologies (AVT) cameras, based on their Vimba SDK.
Camera driver for Allied Vision Technologies (AVT) cameras, based on their Vimba SDK.
|
|
1 | 2023-05-25 | rviz |
3D visualization tool for ROS.
3D visualization tool for ROS.
|
|
1 | 2023-05-24 | xacro |
Xacro (XML Macros)
Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
Xacro (XML Macros)
Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
|
|
1 | 2023-05-24 | rqt_image_view |
rqt_image_view provides a GUI plugin for displaying images using image_transport.
rqt_image_view provides a GUI plugin for displaying images using image_transport.
|
|
1 | 2023-05-24 | mongodb_store_msgs |
The mongodb_store_msgs package
The mongodb_store_msgs package
|
|
1 | 2023-05-24 | mongodb_store |
A package to support MongoDB-based storage and analysis for data from a ROS system, eg. saved messages, configurations etc
A package to support MongoDB-based storage and analysis for data from a ROS system, eg. saved messages, configurations etc
|
|
1 | 2023-05-24 | mongodb_log |
The mongodb_log package
The mongodb_log package
|
|
1 | 2023-05-23 | tf2_client |
Configurable tf2 client wrapper using local or remote buffer.
Configurable tf2 client wrapper using local or remote buffer.
|
|
1 | 2023-05-21 | libcreate |
C++ library for interfacing with iRobot's Create 1 and Create 2
C++ library for interfacing with iRobot's Create 1 and Create 2
|
|
1 | 2023-05-21 | create_robot |
ROS driver for iRobot's Create 1 and 2, based on the libcreate C++ library
ROS driver for iRobot's Create 1 and 2, based on the libcreate C++ library
|
|
1 | 2023-05-21 | create_msgs |
Common message definitions for create_robot
Common message definitions for create_robot
|
|
1 | 2023-05-21 | create_driver |
ROS driver for iRobot's Create and Roomba platforms, based on libcreate
ROS driver for iRobot's Create and Roomba platforms, based on libcreate
|
|
1 | 2023-05-21 | create_description |
Robot URDF descriptions for create_robot
Robot URDF descriptions for create_robot
|
|
1 | 2023-05-21 | create_bringup |
Launch and configuration files for common accessories when working with Create/Roomba platforms.
Launch and configuration files for common accessories when working with Create/Roomba platforms.
|
|
1 | 2023-05-12 | grpc |
Catkinized gRPC Package
Catkinized gRPC Package
|
|
2 | 2023-05-05 | mavlink |
MAVLink message marshaling library.
This package provides C-headers and C++11 library
for both 1.0 and 2.0 versions of protocol.
For pymavlink use separate install via rosdep (python-pymavlink).
MAVLink message marshaling library.
This package provides C-headers and C++11 library
for both 1.0 and 2.0 versions of protocol.
For pymavlink use separate install via rosdep (python-pymavlink).
|
|
1 | 2023-05-04 | teleop_tools_msgs |
The teleop_tools_msgs package
The teleop_tools_msgs package
|
|
1 | 2023-05-04 | teleop_tools |
A set of generic teleoperation tools for any robot.
A set of generic teleoperation tools for any robot.
|
|
1 | 2023-05-04 | mouse_teleop |
A mouse teleop tool for holonomic mobile robots.
A mouse teleop tool for holonomic mobile robots.
|
|
1 | 2023-05-04 | key_teleop |
A text-based interface to send a robot movement commands
A text-based interface to send a robot movement commands
|
|
1 | 2023-05-04 | joy_teleop |
A (to be) generic joystick interface to control a robot
A (to be) generic joystick interface to control a robot
|
|
1 | 2023-05-02 | spatio_temporal_voxel_layer |
The spatio-temporal 3D obstacle costmap package
The spatio-temporal 3D obstacle costmap package
|
|
1 | 2023-05-01 | rviz_satellite |
Display satellite map tiles in RViz
Display satellite map tiles in RViz
|
|
1 | 2023-04-27 | xsens_driver |
ROS Driver for XSens MT/MTi/MTi-G devices.
ROS Driver for XSens MT/MTi/MTi-G devices.
|
|
1 | 2023-04-26 | qb_move_hardware_interface |
This package contains the hardware interface for qbrobotics® qbmove device.
This package contains the hardware interface for qbrobotics® qbmove device.
|
|
1 | 2023-04-26 | qb_move_gazebo |
This package contains the Gazebo ROS control plugins for qbrobotics® qbmove device.
This package contains the Gazebo ROS control plugins for qbrobotics® qbmove device.
|
|
1 | 2023-04-26 | qb_move_description |
This package contains the ROS description for qbrobotics® qbmove device.
This package contains the ROS description for qbrobotics® qbmove device.
|
|
1 | 2023-04-26 | qb_move_control |
This package contains the ROS control node for qbrobotics® qbmove device.
This package contains the ROS control node for qbrobotics® qbmove device.
|
|
1 | 2023-04-26 | qb_move |
This package contains the ROS interface for qbrobotics® qbmove device.
This package contains the ROS interface for qbrobotics® qbmove device.
|
|
1 | 2023-04-26 | qb_hand_hardware_interface |
This package contains the hardware interface for qbrobotics® qbhand device.
This package contains the hardware interface for qbrobotics® qbhand device.
|