Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | dwb_plugins | ||||
| 2 | dwb_msgs | ||||
| 1 | dwb_local_planner | ||||
| 2 | dwb_critics | ||||
| 1 | dwb_core | ||||
| 1 | dwb_controller | ||||
| 2 | dwa_local_planner | ||||
| 1 | dummy_slam_broadcaster | ||||
| 1 | 2018-10-29 | dummy_sensors |
dummy sensor nodes
dummy sensor nodes
|
||
| 1 | 2018-10-29 | dummy_robot_bringup |
dummy robot bringup
dummy robot bringup
|
||
| 1 | 2018-10-29 | dummy_map_server |
dummy map server node
dummy map server node
|
||
| 1 | dt_local_planner | ||||
| 1 | dsr_msgs | ||||
| 1 | dsr_launcher | ||||
| 1 | dsr_gazebo | ||||
| 1 | dsr_example_py | ||||
| 1 | dsr_example_cpp | ||||
| 1 | dsr_description | ||||
| 1 | dsr_control | ||||
| 1 | dsr_bringup | ||||
| 1 | drums_ros | ||||
| 1 | driver_common | ||||
| 1 | driver_base | ||||
| 1 | drc_valve_task | ||||
| 1 | drc_task_common | ||||
| 1 | drc_slam | ||||
| 1 | drc_podo_connector | ||||
| 1 | drc_plugin | ||||
| 1 | drc_navi | ||||
| 1 | drc_hubo | ||||
| 1 | drc_com_common | ||||
| 1 | drawing_handler | ||||
| 1 | draw_demo | ||||
| 1 | dr_cmake | ||||
| 1 | dr_base | ||||
| 1 | downward | ||||
| 1 | doosan_robotics | ||||
| 1 | doosan_robot | ||||
| 1 | docomo_perception | ||||
| 1 | dockeros | ||||
| 1 | dnn_detect | ||||
| 0 | dna_extraction_msgs | ||||
| 1 | dmu_ros | ||||
| 1 | dm_lizi | ||||
| 1 | dlux_plugins | ||||
| 1 | dlux_global_planner | ||||
| 1 | dlut_viso2_ros | ||||
| 1 | dlut_viso2 | ||||
| 1 | dlut_vision | ||||
| 1 | dlut_smartrob |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-09-11 | ecl_exceptions |
Template based exceptions - these are simple and practical
and avoid the proliferation of exception types. Although not
syntatactically ideal, it is convenient and eminently practical.
Template based exceptions - these are simple and practical
and avoid the proliferation of exception types. Although not
syntatactically ideal, it is convenient and eminently practical.
|
||
| 1 | 2016-06-15 | ecl_errors |
This library provides lean and mean error mechanisms.
It includes c style error functions as well as a few
useful macros. For higher level mechanisms,
refer to ecl_exceptions.
This library provides lean and mean error mechanisms.
It includes c style error functions as well as a few
useful macros. For higher level mechanisms,
refer to ecl_exceptions.
|
||
| 1 | 2018-09-11 | ecl_eigen |
This provides an Eigen implementation for ecl's linear algebra.
This provides an Eigen implementation for ecl's linear algebra.
|
||
| 1 | 2018-09-11 | ecl_devices |
Provides an extensible and standardised framework for input-output devices.
Provides an extensible and standardised framework for input-output devices.
|
||
| 1 | 2018-09-11 | ecl_core_apps |
This includes a suite of programs demo'ing various aspects of the
ecl_core. It also includes various benchmarking and utility programs for
use primarily with embedded systems.
This includes a suite of programs demo'ing various aspects of the
ecl_core. It also includes various benchmarking and utility programs for
use primarily with embedded systems.
|
||
| 1 | 2018-09-11 | ecl_core |
A set of tools and interfaces extending the capabilities of c++ to
provide a lightweight, consistent interface with a focus for control
programming.
A set of tools and interfaces extending the capabilities of c++ to
provide a lightweight, consistent interface with a focus for control
programming.
|
||
| 1 | 2016-06-15 | ecl_converters_lite |
These are a very simple version of some of the functions in ecl_converters
suitable for firmware development. That is, there is no use of new,
templates or exceptions.
These are a very simple version of some of the functions in ecl_converters
suitable for firmware development. That is, there is no use of new,
templates or exceptions.
|
||
| 1 | 2018-09-11 | ecl_converters |
Some fast/convenient type converters, mostly for char strings or strings.
These are not really fully fleshed out, alot of them could use the addition for
the whole range of fundamental types (e.g. all integers, not just int, unsigned int).
They will come as the need arises.
Some fast/convenient type converters, mostly for char strings or strings.
These are not really fully fleshed out, alot of them could use the addition for
the whole range of fundamental types (e.g. all integers, not just int, unsigned int).
They will come as the need arises.
|
||
| 1 | 2018-09-11 | ecl_containers |
The containers included here are intended to extend the stl containers.
In all cases, these implementations are designed to implement
c++ conveniences and safety where speed is not sacrificed.
Also includes techniques for memory debugging of common problems such
as buffer overruns.
The containers included here are intended to extend the stl containers.
In all cases, these implementations are designed to implement
c++ conveniences and safety where speed is not sacrificed.
Also includes techniques for memory debugging of common problems such
as buffer overruns.
|
||
| 1 | 2016-06-15 | ecl_console |
Color codes for ansii consoles.
Color codes for ansii consoles.
|
||
| 1 | 2016-06-15 | ecl_config |
These tools inspect and describe your system with macros, types
and functions.
These tools inspect and describe your system with macros, types
and functions.
|
||
| 1 | 2018-09-11 | ecl_concepts |
Introduces a compile time concept checking mechanism that can be used
most commonly to check for required functionality when passing
template arguments.
Introduces a compile time concept checking mechanism that can be used
most commonly to check for required functionality when passing
template arguments.
|
||
| 1 | 2018-09-11 | ecl_command_line |
Embeds the TCLAP library inside the ecl. This is a very convenient
command line parser in templatised c++.
Embeds the TCLAP library inside the ecl. This is a very convenient
command line parser in templatised c++.
|
||
| 1 | 2017-08-06 | ecl_build |
Collection of cmake/make build tools primarily for ecl development itself, but also
contains a few cmake modules useful outside of the ecl.
Collection of cmake/make build tools primarily for ecl development itself, but also
contains a few cmake modules useful outside of the ecl.
|
||
| 1 | 2018-09-11 | ecl |
Metapackage bringing all of ecl together.
Metapackage bringing all of ecl together.
|
||
| 1 | 2019-04-25 | eca_a9_gazebo |
Package with launch files for demonstrations with the ECA A9 AUV
Package with launch files for demonstrations with the ECA A9 AUV
|
||
| 1 | 2019-04-25 | eca_a9_description |
Robot description for the ECA A9 AUV
Robot description for the ECA A9 AUV
|
||
| 1 | 2019-04-25 | eca_a9_control |
Configuration and launch files to control the ECA A9 AUV
Configuration and launch files to control the ECA A9 AUV
|
||
| 2 | eband_local_planner | ||||
| 1 | 2016-07-23 | easy_markers |
Python library to assist in publishing markers easily
Python library to assist in publishing markers easily
|
||
| 1 | earth_rover_piksi | ||||
| 1 | earth_rover_localization | ||||
| 1 | dynpick_driver | ||||
| 1 | 2019-01-03 | dynamixel_workbench_single_manager_gui |
It provides a grapic user interface to check the status of Dynamixel and control it before using Dynamixel
It provides a grapic user interface to check the status of Dynamixel and control it before using Dynamixel
|
||
| 1 | 2019-01-03 | dynamixel_workbench_single_manager |
This package is single manager for a Dynamixel.
It provides a terminal environment to check the status of Dynamixel and control it before using Dynamixel
This package is single manager for a Dynamixel.
It provides a terminal environment to check the status of Dynamixel and control it before using Dynamixel
|
||
| 1 | 2019-01-03 | dynamixel_workbench_operators |
This package contains nodes that control the Dynamixel by communicating with the server registered in the 'dynamixel_workbench_controllers' package
This package contains nodes that control the Dynamixel by communicating with the server registered in the 'dynamixel_workbench_controllers' package
|
||
| 1 | 2019-01-03 | dynamixel_workbench_msgs |
This package includes ROS messages and services for dynamixel_workbench packages
This package includes ROS messages and services for dynamixel_workbench packages
|
||
| 1 | 2019-01-03 | dynamixel_workbench_controllers |
This package contains examples of applying the 'dynamixel_workbench_toolbox' library developed on the basis of dynamixel_sdk to various operating modes of Dynamixel.
This package contains examples of applying the 'dynamixel_workbench_toolbox' library developed on the basis of dynamixel_sdk to various operating modes of Dynamixel.
|
||
| 1 | 2019-01-03 | dynamixel_workbench |
Dynamixel-Workbench is dynamixel solution for ROS.
This metapackage allows you to easily change the ID, baudrate and operating mode of the Dynamixel.
Furthermore, it supports various controllers based on operating mode and Dynamixel SDK.
These controllers are commanded by operators.
Dynamixel-Workbench is dynamixel solution for ROS.
This metapackage allows you to easily change the ID, baudrate and operating mode of the Dynamixel.
Furthermore, it supports various controllers based on operating mode and Dynamixel SDK.
These controllers are commanded by operators.
|
||
| 1 | dynamixel_tutorials | ||||
| 1 | 2019-01-03 | dynamixel_sdk |
This package is wrapping version of ROBOTIS Dynamxel SDK for ROS. 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 Dynamxel SDK for ROS. 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 | dynamixel_pro_moveit_controller | ||||
| 1 | dynamixel_pro_driver | ||||
| 1 | dynamixel_pro_controller | ||||
| 1 | dynamixel_pro_arm_moveit_config | ||||
| 1 | dynamixel_pro_arm_description | ||||
| 1 | dynamixel_pro_arm | ||||
| 1 | dynamixel_msgs | ||||
| 1 | dynamixel_motor | ||||
| 1 | dynamixel_hardware_interface | ||||
| 1 | dynamixel_driver | ||||
| 1 | dynamixel_controllers | ||||
| 1 | dynamixel_control_hw | ||||
| 1 | dynamicvoronoi | ||||
| 1 | dynamic_transform_publisher | ||||
| 1 | 2019-05-22 | dynamic_tf_publisher |
dynamically set the tf trensformation
dynamically set the tf trensformation
|
||
| 1 | 2019-03-06 | dynamic_reconfigure |
This unary stack contains the dynamic_reconfigure package which provides a means to change
node parameters at any time without having to restart the node.
This unary stack contains the dynamic_reconfigure package which provides a means to change
node parameters at any time without having to restart the node.
|
||
| 1 | dynamic_map | ||||
| 1 | dynamic_bandwidth_manager | ||||
| 1 | dyn_tune |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | ecl_command_line | ||||
| 1 | 2017-08-06 | ecl_build |
Collection of cmake/make build tools primarily for ecl development itself, but also
contains a few cmake modules useful outside of the ecl.
Collection of cmake/make build tools primarily for ecl development itself, but also
contains a few cmake modules useful outside of the ecl.
|
||
| 1 | ecl | ||||
| 1 | 2019-04-25 | eca_a9_gazebo |
Package with launch files for demonstrations with the ECA A9 AUV
Package with launch files for demonstrations with the ECA A9 AUV
|
||
| 1 | 2019-04-25 | eca_a9_description |
Robot description for the ECA A9 AUV
Robot description for the ECA A9 AUV
|
||
| 1 | 2019-04-25 | eca_a9_control |
Configuration and launch files to control the ECA A9 AUV
Configuration and launch files to control the ECA A9 AUV
|
||
| 2 | eband_local_planner | ||||
| 1 | 2016-07-23 | easy_markers |
Python library to assist in publishing markers easily
Python library to assist in publishing markers easily
|
||
| 1 | earth_rover_piksi | ||||
| 1 | earth_rover_localization | ||||
| 1 | dynamixel_workbench_toolbox | ||||
| 1 | dynamixel_workbench_single_manager_gui | ||||
| 1 | dynamixel_workbench_single_manager | ||||
| 1 | dynamixel_workbench_operators | ||||
| 1 | dynamixel_workbench_msgs | ||||
| 1 | dynamixel_workbench_controllers | ||||
| 1 | dynamixel_workbench | ||||
| 1 | dynamixel_tutorials | ||||
| 1 | dynamixel_sdk | ||||
| 1 | dynamixel_pro_moveit_controller | ||||
| 1 | dynamixel_pro_driver | ||||
| 1 | dynamixel_pro_controller | ||||
| 1 | dynamixel_pro_arm_moveit_config | ||||
| 1 | dynamixel_pro_arm_description | ||||
| 1 | dynamixel_pro_arm | ||||
| 1 | dynamixel_msgs | ||||
| 1 | dynamixel_motor | ||||
| 1 | dynamixel_hardware_interface | ||||
| 1 | dynamixel_driver | ||||
| 1 | dynamixel_controllers | ||||
| 1 | dynamixel_control_hw | ||||
| 1 | dynamicvoronoi | ||||
| 1 | dynamic_transform_publisher | ||||
| 1 | dynamic_tf_publisher | ||||
| 1 | 2018-10-02 | dynamic_reconfigure |
This unary stack contains the dynamic_reconfigure package which provides a means to change
node parameters at any time without having to restart the node.
This unary stack contains the dynamic_reconfigure package which provides a means to change
node parameters at any time without having to restart the node.
|
||
| 1 | dynamic_map | ||||
| 1 | dynamic_bandwidth_manager | ||||
| 1 | dyn_tune | ||||
| 2 | 2019-05-24 | dwb_msgs |
Message/Service definitions specifically for the dwb_local_planner
Message/Service definitions specifically for the dwb_local_planner
|
||
| 1 | dwb_core | ||||
| 1 | dwb_controller | ||||
| 2 | 2019-02-28 | dwa_local_planner |
This package provides an implementation of the Dynamic Window Approach to
local robot navigation on a plane. Given a global plan to follow and a
costmap, the local planner produces velocity commands to send to a mobile
base. This package supports any robot who's footprint can be represented as
a convex polygon or cicrle, and exposes its configuration as ROS parameters
that can be set in a launch file. The parameters for this planner are also
dynamically reconfigurable. This package's ROS wrapper adheres to the
BaseLocalPlanner interface specified in the
This package provides an implementation of the Dynamic Window Approach to
local robot navigation on a plane. Given a global plan to follow and a
costmap, the local planner produces velocity commands to send to a mobile
base. This package supports any robot who's footprint can be represented as
a convex polygon or cicrle, and exposes its configuration as ROS parameters
that can be set in a launch file. The parameters for this planner are also
dynamically reconfigurable. This package's ROS wrapper adheres to the
BaseLocalPlanner interface specified in the
|
||
| 1 | dummy_slam_broadcaster | ||||
| 1 | dummy_sensors | ||||
| 1 | dummy_robot_bringup | ||||
| 1 | dummy_map_server | ||||
| 1 | dt_local_planner | ||||
| 1 | dsr_msgs | ||||
| 1 | dsr_launcher | ||||
| 1 | dsr_gazebo |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2019-05-23 | exotica_python |
Python bindings for EXOTica
Python bindings for EXOTica
|
||
| 1 | 2019-05-23 | exotica_pinocchio_dynamics_solver |
Dynamics solver plug-in using Pinocchio for Exotica
Dynamics solver plug-in using Pinocchio for Exotica
|
||
| 1 | 2019-05-23 | exotica_ompl_solver |
Exotica solvers based on the Open Motion Planning Libary (OMPL)
Exotica solvers based on the Open Motion Planning Libary (OMPL)
|
||
| 1 | 2019-05-23 | exotica_levenberg_marquardt_solver |
A Levenberg-Marquardt solver for EXOTica
A Levenberg-Marquardt solver for EXOTica
|
||
| 1 | 2019-05-23 | exotica_ik_solver |
Pseudo-inverse unconstrained end-pose solver
Pseudo-inverse unconstrained end-pose solver
|
||
| 1 | 2019-05-23 | exotica_double_integrator_dynamics_solver |
Double integrator dynamics solver plug-in for Exotica
Double integrator dynamics solver plug-in for Exotica
|
||
| 1 | 2019-05-23 | exotica_core_task_maps |
Common taskmaps provided with EXOTica.
Common taskmaps provided with EXOTica.
|
||
| 1 | 2019-05-23 | 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 | 2019-05-23 | 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 | 2019-05-23 | exotica_collision_scene_fcl |
Collision checking using the FCL library.
Collision checking using the FCL library.
|
||
| 1 | 2019-05-23 | exotica_aico_solver |
Implementation of the Approximate Inference Control algorithm (AICO)
Implementation of the Approximate Inference Control algorithm (AICO)
|
||
| 1 | 2019-05-23 | 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 | 2018-09-08 | executive_smach_visualization |
This metapackage depends on the SMACH visualization tools.
This metapackage depends on the SMACH visualization tools.
|
||
| 1 | 2018-04-13 | executive_smach |
This metapackage depends on the SMACH library and ROS SMACH integration
packages.
This metapackage depends on the SMACH library and ROS SMACH integration
packages.
|
||
| 1 | examples_rclpy_minimal_subscriber | ||||
| 1 | examples_rclpy_minimal_service | ||||
| 1 | examples_rclpy_minimal_publisher | ||||
| 1 | examples_rclpy_minimal_client | ||||
| 1 | examples_rclpy_minimal_action_server | ||||
| 1 | examples_rclpy_minimal_action_client | ||||
| 1 | examples_rclpy_executors | ||||
| 1 | examples_rclcpp_minimal_timer | ||||
| 1 | examples_rclcpp_minimal_subscriber | ||||
| 1 | examples_rclcpp_minimal_service | ||||
| 1 | examples_rclcpp_minimal_publisher | ||||
| 1 | examples_rclcpp_minimal_composition | ||||
| 1 | examples_rclcpp_minimal_client | ||||
| 1 | examples_rclcpp_minimal_action_server | ||||
| 1 | examples_rclcpp_minimal_action_client | ||||
| 1 | example_interfaces | ||||
| 1 | evarobot_viz | ||||
| 1 | evarobot_state_publisher | ||||
| 1 | evarobot_slam | ||||
| 1 | evarobot_simulator | ||||
| 1 | evarobot_pose_ekf | ||||
| 1 | evarobot_navigation | ||||
| 1 | evarobot_gazebo | ||||
| 1 | evarobot_diagnostics | ||||
| 1 | evarobot_description | ||||
| 1 | evarobot_competition | ||||
| 1 | evapc_start | ||||
| 1 | evapc_ros | ||||
| 1 | 2018-12-05 | euslisp_model_conversion_tester |
euslisp_model_conversion_tester
euslisp_model_conversion_tester
|
||
| 1 | eusgazebo | ||||
| 1 | 2018-12-05 | euscollada |
euscollada
euscollada
|
||
| 1 | 2019-04-16 | eus_qpoases |
eus_qpoases
eus_qpoases
|
||
| 1 | 2019-04-16 | eus_nlopt |
eus_nlopt
eus_nlopt
|
||
| 2 | 2018-12-05 | eus_assimp |
eus_assimp
eus_assimp
|
||
| 1 | ethzasl_point_cloud_vtk_tools | ||||
| 1 | ethzasl_icp_mapping |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2017-04-10 | face_detector |
Face detection in images.
Face detection in images.
|
||
| 0 | f_and_rb_tracker | ||||
| 1 | ez_interactive_marker | ||||
| 1 | 2015-07-03 | explorer |
The explorer package utilizes frontier based exploration for multi-robot systems. Beside frontier detection, coordinated and uncoordinated exploration strategies are available to select goal points. Coordinated exploration enhances robot distribution and reduces redundancy in exploration reducing exploration time.
The explorer package utilizes frontier based exploration for multi-robot systems. Beside frontier detection, coordinated and uncoordinated exploration strategies are available to select goal points. Coordinated exploration enhances robot distribution and reduces redundancy in exploration reducing exploration time.
|
||
| 1 | explore_lite | ||||
| 1 | exploration_server | ||||
| 1 | exploration_msgs | ||||
| 1 | exploration | ||||
| 1 | exotica_val_description | ||||
| 1 | exotica_time_indexed_rrt_connect_solver | ||||
| 1 | exotica_scipy_solver | ||||
| 1 | exotica_quadrotor_dynamics_solver | ||||
| 1 | exotica_python | ||||
| 1 | exotica_pinocchio_dynamics_solver | ||||
| 1 | exotica_ompl_solver | ||||
| 1 | exotica_levenberg_marquardt_solver | ||||
| 1 | exotica_ik_solver | ||||
| 1 | exotica_examples | ||||
| 1 | exotica_double_integrator_dynamics_solver | ||||
| 1 | exotica_core_task_maps | ||||
| 1 | exotica_core | ||||
| 1 | exotica_collision_scene_fcl_latest | ||||
| 1 | exotica_collision_scene_fcl | ||||
| 1 | exotica_aico_solver | ||||
| 1 | exotica | ||||
| 1 | 2018-09-08 | executive_smach_visualization |
This metapackage depends on the SMACH visualization tools.
This metapackage depends on the SMACH visualization tools.
|
||
| 1 | 2018-04-13 | executive_smach |
This metapackage depends on the SMACH library and ROS SMACH integration
packages.
This metapackage depends on the SMACH library and ROS SMACH integration
packages.
|
||
| 1 | examples_rclpy_minimal_subscriber | ||||
| 1 | examples_rclpy_minimal_service | ||||
| 1 | examples_rclpy_minimal_publisher | ||||
| 1 | examples_rclpy_minimal_client | ||||
| 1 | examples_rclpy_minimal_action_server | ||||
| 1 | examples_rclpy_minimal_action_client | ||||
| 1 | examples_rclpy_executors | ||||
| 1 | examples_rclcpp_minimal_timer | ||||
| 1 | examples_rclcpp_minimal_subscriber | ||||
| 1 | examples_rclcpp_minimal_service | ||||
| 1 | examples_rclcpp_minimal_publisher | ||||
| 1 | examples_rclcpp_minimal_composition | ||||
| 1 | examples_rclcpp_minimal_client | ||||
| 1 | examples_rclcpp_minimal_action_server | ||||
| 1 | examples_rclcpp_minimal_action_client | ||||
| 1 | example_interfaces | ||||
| 1 | 2016-07-24 | evarobot_viz |
Visualization configuration for the Evarobot.
Visualization configuration for the Evarobot.
|
||
| 1 | 2016-07-24 | evarobot_state_publisher |
evarobot_state_publisher provides tf information of Evarobot links.
evarobot_state_publisher provides tf information of Evarobot links.
|
||
| 1 | 2016-07-24 | evarobot_slam |
evarobot_slam provides roslaunch scripts for SLAM map building with the Evarobot.
evarobot_slam provides roslaunch scripts for SLAM map building with the Evarobot.
|
||
| 1 | 2016-03-09 | evarobot_simulator |
The evarobot_simulator meta package provides all the basic packages for Gazebo model.
The evarobot_simulator meta package provides all the basic packages for Gazebo model.
|
||
| 1 | 2016-07-24 | evarobot_pose_ekf |
evarobot_pose_ekf provides roslaunch scripts for correction of the Evarobot's orientation with an IMU sensor.
evarobot_pose_ekf provides roslaunch scripts for correction of the Evarobot's orientation with an IMU sensor.
|
||
| 1 | 2016-07-24 | evarobot_navigation |
evarobot_navigation provides roslaunch script files to navigate the Evarobot.
evarobot_navigation provides roslaunch script files to navigate the Evarobot.
|
||
| 1 | 2016-03-09 | evarobot_gazebo |
evarobot simulator bringup.
evarobot simulator bringup.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 2 | dwb_msgs | ||||
| 1 | dwb_local_planner | ||||
| 2 | dwb_critics | ||||
| 1 | dwb_core | ||||
| 1 | dwb_controller | ||||
| 2 | dwa_local_planner | ||||
| 1 | dummy_slam_broadcaster | ||||
| 1 | 2017-12-08 | dummy_sensors |
dummy sensor nodes
dummy sensor nodes
|
||
| 1 | 2017-12-08 | dummy_robot_bringup |
dummy robot bringup
dummy robot bringup
|
||
| 1 | 2017-12-08 | dummy_map_server |
dummy map server node
dummy map server node
|
||
| 1 | dt_local_planner | ||||
| 1 | dsr_msgs | ||||
| 1 | dsr_launcher | ||||
| 1 | dsr_gazebo | ||||
| 1 | dsr_example_py | ||||
| 1 | dsr_example_cpp | ||||
| 1 | dsr_description | ||||
| 1 | dsr_control | ||||
| 1 | dsr_bringup | ||||
| 1 | drums_ros | ||||
| 1 | driver_common | ||||
| 1 | driver_base | ||||
| 1 | drc_valve_task | ||||
| 1 | drc_task_common | ||||
| 1 | drc_slam | ||||
| 1 | drc_podo_connector | ||||
| 1 | drc_plugin | ||||
| 1 | drc_navi | ||||
| 1 | drc_hubo | ||||
| 1 | drc_com_common | ||||
| 1 | drawing_handler | ||||
| 1 | draw_demo | ||||
| 1 | dr_cmake | ||||
| 1 | dr_base | ||||
| 1 | downward | ||||
| 1 | doosan_robotics | ||||
| 1 | doosan_robot | ||||
| 1 | docomo_perception | ||||
| 1 | dockeros | ||||
| 1 | dnn_detect | ||||
| 0 | dna_extraction_msgs | ||||
| 1 | dmu_ros | ||||
| 1 | dm_lizi | ||||
| 1 | dlux_plugins | ||||
| 1 | dlux_global_planner | ||||
| 1 | dlut_viso2_ros | ||||
| 1 | dlut_viso2 | ||||
| 1 | dlut_vision | ||||
| 1 | dlut_smartrob | ||||
| 0 | dlut_place_recognition |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-12-31 | ecl_command_line |
Embeds the TCLAP library inside the ecl. This is a very convenient
command line parser in templatised c++.
Embeds the TCLAP library inside the ecl. This is a very convenient
command line parser in templatised c++.
|
||
| 1 | 2018-12-31 | ecl_build |
Collection of cmake/make build tools primarily for ecl development itself, but also
contains a few cmake modules useful outside of the ecl.
Collection of cmake/make build tools primarily for ecl development itself, but also
contains a few cmake modules useful outside of the ecl.
|
||
| 1 | 2018-09-11 | ecl |
Metapackage bringing all of ecl together.
Metapackage bringing all of ecl together.
|
||
| 1 | eca_a9_gazebo | ||||
| 1 | eca_a9_description | ||||
| 1 | eca_a9_control | ||||
| 2 | eband_local_planner | ||||
| 1 | 2015-07-11 | easy_markers |
Python library to assist in publishing markers easily
Python library to assist in publishing markers easily
|
||
| 1 | earth_rover_piksi | ||||
| 1 | earth_rover_localization | ||||
| 1 | dynamixel_workbench_toolbox | ||||
| 1 | dynamixel_workbench_single_manager_gui | ||||
| 1 | dynamixel_workbench_single_manager | ||||
| 1 | dynamixel_workbench_operators | ||||
| 1 | dynamixel_workbench_msgs | ||||
| 1 | dynamixel_workbench_controllers | ||||
| 1 | dynamixel_workbench | ||||
| 1 | 2017-02-20 | dynamixel_tutorials |
Example configuration and launch file for dynamixel_motor stack.
Example configuration and launch file for dynamixel_motor stack.
|
||
| 1 | dynamixel_sdk | ||||
| 1 | dynamixel_pro_moveit_controller | ||||
| 1 | dynamixel_pro_driver | ||||
| 1 | dynamixel_pro_controller | ||||
| 1 | dynamixel_pro_arm_moveit_config | ||||
| 1 | dynamixel_pro_arm_description | ||||
| 1 | dynamixel_pro_arm | ||||
| 1 | 2017-02-20 | dynamixel_msgs |
Common messages used throughout dynamixel_motor stack.
Common messages used throughout dynamixel_motor stack.
|
||
| 1 | 2017-02-20 | dynamixel_motor |
This stack contains packages that are used to interface with Robotis
Dynamixel line of servo motors. This stack was tested with and fully
supports AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, MX-64, EX-106 and
MX-106 models.
This stack contains packages that are used to interface with Robotis
Dynamixel line of servo motors. This stack was tested with and fully
supports AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, MX-64, EX-106 and
MX-106 models.
|
||
| 1 | dynamixel_hardware_interface | ||||
| 1 | 2017-02-20 | dynamixel_driver |
This package provides low level IO for Robotis Dynamixel servos.
Fully supports and was tested with AX-12, AX-18, RX-24, RX-28,
MX-28, RX-64, EX-106 models. Hardware specific constants are
defined for reading and writing information from/to Dynamixel
servos. This low level package won't be used directly by most
ROS users. The higher level dynamixel_controllers and specific
robot joint controllers make use of this package.
This package provides low level IO for Robotis Dynamixel servos.
Fully supports and was tested with AX-12, AX-18, RX-24, RX-28,
MX-28, RX-64, EX-106 models. Hardware specific constants are
defined for reading and writing information from/to Dynamixel
servos. This low level package won't be used directly by most
ROS users. The higher level dynamixel_controllers and specific
robot joint controllers make use of this package.
|
||
| 1 | 2017-02-20 | dynamixel_controllers |
This package contains a configurable node, services and a spawner script
to start, stop and restart one or more controller plugins. Reusable
controller types are defined for common Dynamixel motor joints. Both speed and
torque can be set for each joint. This python package can be used by more
specific robot controllers and all configurable parameters can be loaded
via a yaml file.
This package contains a configurable node, services and a spawner script
to start, stop and restart one or more controller plugins. Reusable
controller types are defined for common Dynamixel motor joints. Both speed and
torque can be set for each joint. This python package can be used by more
specific robot controllers and all configurable parameters can be loaded
via a yaml file.
|
||
| 1 | dynamixel_control_hw | ||||
| 1 | dynamicvoronoi | ||||
| 1 | dynamic_transform_publisher | ||||
| 1 | 2019-05-22 | dynamic_tf_publisher |
dynamically set the tf trensformation
dynamically set the tf trensformation
|
||
| 1 | dynamic_robot_state_publisher | ||||
| 1 | 2018-10-02 | dynamic_reconfigure |
This unary stack contains the dynamic_reconfigure package which provides a means to change
node parameters at any time without having to restart the node.
This unary stack contains the dynamic_reconfigure package which provides a means to change
node parameters at any time without having to restart the node.
|
||
| 1 | dynamic_map | ||||
| 1 | dynamic_bandwidth_manager | ||||
| 1 | dyn_tune | ||||
| 2 | dwb_plugins | ||||
| 2 | dwb_msgs | ||||
| 1 | dwb_local_planner | ||||
| 2 | dwb_critics | ||||
| 1 | dwb_core | ||||
| 1 | dwb_controller | ||||
| 2 | 2016-11-13 | dwa_local_planner |
This package provides an implementation of the Dynamic Window Approach to
local robot navigation on a plane. Given a global plan to follow and a
costmap, the local planner produces velocity commands to send to a mobile
base. This package supports any robot who's footprint can be represented as
a convex polygon or cicrle, and exposes its configuration as ROS parameters
that can be set in a launch file. The parameters for this planner are also
dynamically reconfigurable. This package's ROS wrapper adheres to the
BaseLocalPlanner interface specified in the
This package provides an implementation of the Dynamic Window Approach to
local robot navigation on a plane. Given a global plan to follow and a
costmap, the local planner produces velocity commands to send to a mobile
base. This package supports any robot who's footprint can be represented as
a convex polygon or cicrle, and exposes its configuration as ROS parameters
that can be set in a launch file. The parameters for this planner are also
dynamically reconfigurable. This package's ROS wrapper adheres to the
BaseLocalPlanner interface specified in the
|
||
| 1 | 2016-09-15 | dummy_slam_broadcaster |
The dummy_slam_broadcaster package
The dummy_slam_broadcaster package
|
||
| 1 | dummy_sensors | ||||
| 1 | dummy_robot_bringup | ||||
| 1 | dummy_map_server |
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | ecl_math | ||||
| 2 | ecl_manipulators | ||||
| 1 | ecl_manipulation | ||||
| 1 | ecl_lite | ||||
| 1 | ecl_linear_algebra | ||||
| 1 | ecl_license | ||||
| 1 | ecl_ipc | ||||
| 1 | ecl_io | ||||
| 1 | ecl_geometry | ||||
| 1 | ecl_formatters | ||||
| 1 | ecl_filesystem | ||||
| 1 | ecl_exceptions | ||||
| 1 | ecl_errors | ||||
| 1 | ecl_eigen | ||||
| 1 | ecl_devices | ||||
| 1 | ecl_core_apps | ||||
| 1 | ecl_core | ||||
| 1 | ecl_converters_lite | ||||
| 1 | ecl_converters | ||||
| 1 | ecl_containers | ||||
| 1 | ecl_console | ||||
| 1 | ecl_config | ||||
| 1 | ecl_concepts | ||||
| 1 | ecl_command_line | ||||
| 1 | ecl_build | ||||
| 1 | ecl | ||||
| 1 | eca_a9_gazebo | ||||
| 1 | eca_a9_description | ||||
| 1 | eca_a9_control | ||||
| 2 | 2014-07-29 | eband_local_planner |
The eband_local_planner package implements a plugin to the base_local_planner. It implements the Elastic Band method on the SE2 manifold.
The eband_local_planner package implements a plugin to the base_local_planner. It implements the Elastic Band method on the SE2 manifold.
|
||
| 1 | 2015-07-11 | easy_markers |
Python library to assist in publishing markers easily
Python library to assist in publishing markers easily
|
||
| 1 | earth_rover_piksi | ||||
| 1 | earth_rover_localization | ||||
| 1 | dynamixel_workbench_toolbox | ||||
| 1 | dynamixel_workbench_single_manager_gui | ||||
| 1 | dynamixel_workbench_single_manager | ||||
| 1 | dynamixel_workbench_operators | ||||
| 1 | dynamixel_workbench_msgs | ||||
| 1 | dynamixel_workbench_controllers | ||||
| 1 | dynamixel_workbench | ||||
| 1 | 2017-02-20 | dynamixel_tutorials |
Example configuration and launch file for dynamixel_motor stack.
Example configuration and launch file for dynamixel_motor stack.
|
||
| 1 | dynamixel_sdk | ||||
| 1 | 2013-08-20 | dynamixel_pro_moveit_controller |
The dynamixel_pro_moveit_controller package, it interprets joint trajectories and uses the low level drivers to directly control the arm. Avoiding the extra layer of translating the joint_trajectory messages to joint_state messages
The dynamixel_pro_moveit_controller package, it interprets joint trajectories and uses the low level drivers to directly control the arm. Avoiding the extra layer of translating the joint_trajectory messages to joint_state messages
|
||
| 1 | 2013-10-04 | dynamixel_pro_driver |
The dynamixel_pro_driver package
The dynamixel_pro_driver package
|
||
| 1 | 2014-03-28 | dynamixel_pro_controller |
The dynamixel_pro_controller package
The dynamixel_pro_controller package
|
||
| 1 | 2013-08-20 | dynamixel_pro_arm_moveit_config |
An automatically generated package with all the configuration and launch files for using the dynamixel_pro_arm with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the dynamixel_pro_arm with the MoveIt Motion Planning Framework
|
||
| 1 | 2013-08-20 | dynamixel_pro_arm_description |
The dynamixel_pro_arm_description package contains an URDF model of the dynamixel pro arm
The dynamixel_pro_arm_description package contains an URDF model of the dynamixel pro arm
|
||
| 1 | 2013-08-20 | dynamixel_pro_arm |
The dynamixel_pro_arm package
The dynamixel_pro_arm package
|
||
| 1 | 2017-02-20 | dynamixel_msgs |
Common messages used throughout dynamixel_motor stack.
Common messages used throughout dynamixel_motor stack.
|
||
| 1 | 2017-02-20 | dynamixel_motor |
This stack contains packages that are used to interface with Robotis
Dynamixel line of servo motors. This stack was tested with and fully
supports AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, MX-64, EX-106 and
MX-106 models.
This stack contains packages that are used to interface with Robotis
Dynamixel line of servo motors. This stack was tested with and fully
supports AX-12, AX-18, RX-24, RX-28, MX-28, RX-64, MX-64, EX-106 and
MX-106 models.
|