robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 3.0.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version humble
Last Updated 2024-01-24
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package take the joint angles of a robot as input, and publishes the 3D poses of the robot links to tf2, using a kinematic tree model of the robot.

Additional Links

No additional links.

Maintainers

  • Chris Lalancette
  • Shane Loretz

Authors

  • Karsten Knese

Robot State Publisher

This package contains the Robot State Publisher, a node and a class to publish the state of a robot to tf2. At startup time, Robot State Publisher is supplied with a kinematic tree model (URDF) of the robot. It then subscribes to the joint_states topic (of type sensor_msgs/msg/JointState) to get individual joint states. These joint states are used to update the kinematic tree model, and the resulting 3D poses are then published to tf2.

Robot State Publisher deals with two different "classes" of joint types: fixed and movable. Fixed joints (with the type "fixed") are published to the transient_local /tf_static topic once on startup (transient_local topics keep a history of what they published, so a later subscription can always get the latest state of the world). Movable joints are published to the regular /tf topic any time the appropriate joint is updated in the joint_states message.

Examples showing how to pass the robot_description parameter using a launch file are available in the 'launch' subdirectory.

Published Topics

  • robot_description (std_msgs/msg/String) - The description of the robot URDF as a string. Republishes the value set in the robot_description parameter, which is useful for getting informed of dynamic changes to the URDF. Published using the "transient local" quality of service, so subscribers should also be "transient local".
  • tf (tf2_msgs/msg/TFMessage) - The transforms corresponding to the movable joints of the robot.
  • tf_static (tf2_msgs/msg/TFMessage) - The transforms corresponding to the static joints of the robot.

Subscribed Topics

  • joint_states (sensor_msgs/msg/JointState) - The joint state updates to the robot poses. The RobotStatePublisher class takes these updates, does transformations (such as mimic joints), and then publishes the results on the tf2 topics.

Parameters

  • robot_description (string) - The original description of the robot in URDF form. This must be set at robot_state_publisher startup time, or the node will fail to start. Updates to this parameter will be reflected in the robot_description topic.
  • publish_frequency (double) - The maximum frequency at which non-static transforms (e.g. joint states) will be published to /tf. Defaults to 20.0 Hz.
  • ignore_timestamp (bool) - Whether to accept all joint states no matter what the timestamp (true), or to only publish joint state updates if they are newer than the last publish_frequency (false). Defaults to false.
  • frame_prefix (string) - An arbitrary prefix to add to the published tf2 frames. Defaults to the empty string.
CHANGELOG

Changelog for package robot_state_publisher

3.0.3 (2024-01-24)

  • Fix reload after a description with a mimic joint (#212) (#214)
  • Contributors: mergify[bot]

3.0.2 (2022-04-05)

  • Depend on orocos_kdl_vendor (#191)
  • Contributors: Jacob Perron

3.0.1 (2022-03-28)

  • export dependencies, to use robot_state_publisher as a component (#193)
  • Contributors: Kenji Brameld

3.0.0 (2022-01-14)

  • Fix include order for cpplint (#186)
  • Change how parameter updates are handled (#180)
  • Install includes to instal/\${PROJECT_NAME} (#184)
  • Make the change_fixed_joint test more robust (#183)
  • Add in a test to make sure fixed transforms change on update
  • Small C++ nice-isms in the tests
  • Switch to using target_include_directories for tests
  • Publish new fixed transforms when URDF is updated
  • Make joint_states subscription QoS configurable; default to SensorDataQoS (#179)
  • Remove dependency on urdfdom_headers (#168)
  • Contributors: Anthony Deschamps, Chris Lalancette, Jacob Perron, Russell Joyce, Shane Loretz

2.7.0 (2021-10-18)

  • Fix deprecated subscriber callbacks (#173)
  • Contributors: Abrar Rahman Protyasha

2.6.0 (2021-08-02)

  • Cleanup the documentation in the RobotStatePublisher class. (#172)
  • Always publish fixed frames to /tf_static (#158)
  • corrected publish_frequency default in README (#166)
  • Contributors: Chris Lalancette, Jacob Perron, Nils Schulte

2.5.0 (2021-06-11)

  • Add tf frame_prefix parameter (#159)
  • Contributors: Steve Nogar, Chris Lalancette

2.4.3 (2021-04-19)

  • Stop rejecting unknown parameters. (#161)
  • Contributors: Chris Lalancette

2.4.2 (2021-01-25)

  • clean up license to be standard bsd 3 clause (#130)
  • Update the maintainers. (#151)
  • Contributors: Chris Lalancette, Tully Foote

2.4.1 (2020-09-28)

  • fix types in range loops to avoid copy due to different type (#143)
  • Make sure not to crash on an invalid URDF. (#141)
  • Contributors: Chris Lalancette, Dirk Thomas

2.4.0 (2020-04-30)

  • Replace deprecated launch_ros usage (#137)
  • code style only: wrap after open parenthesis if not in one line (#129)
  • Refactor the ROS 2 code to be more modern (#126)
  • Switch to using TARGET_FILE to find the binary targets on Windows.
  • Fix tests on Windows.
  • Make the error message much nicer on Windows.
  • robot_state_publisher_node -> robot_state_publisher
  • Fix test build on Windows.
  • Get rid of redundant declaration.
  • Guard against negative publish_frequencies.
  • Switch to modern launch_testing ReadyToTest.
  • Add testing to robot_state_publisher.
  • Update some example launch files.
  • Implement the ability to change the parameters on the fly.
  • Fix silly bug while computing the publish interval.
  • Refactor to have a \"setup\" function during the constructor and later on during the parameter setup.
  • Mark things as explicit and final.
  • Update the documentation.
  • Make robot_state_publisher composable.
  • Contributors: Chris Lalancette, Dirk Thomas, Jacob Perron

2.3.1 (2019-10-23)

  • Switch the license back to BSD. (#121)
  • Contributors: Chris Lalancette

2.3.0 (2019-09-26)

  • Install include directories (#31)
  • Publish URDF string on startup (#24)
  • Contributors: Patrick Beeson, Poh Zhi-Ee, Shane Loretz

2.2.4 (2019-09-06)

  • Remove unused Eigen3 dependency (#27) (#29)
  • Don\'t export exe as library (#25) (ros2 #28)
  • Contributors: Shane Loretz

2.2.3 (2019-06-12)

  • Use rclcpp::Time for stamping transforms (#20)
  • Contributors: Scott K Logan

2.2.2 (2019-05-08)

  • changes to avoid deprecated API\'s (#19)
  • Contributors: William Woodall

2.2.1 (2019-04-26)

  • Updated to avoid deprecated API. (#18)
  • Contributors: William Woodall

2.2.0 (2019-04-14)

  • Set urdf content as parameter. (#15)
  • Contributors: Karsten Knese

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cartographer_ros github-ros2-cartographer_ros
create_description github-AutonomyLab-create_robot
depthai_bridge github-luxonis-depthai-ros
depthai_descriptions github-luxonis-depthai-ros
depthai_examples github-luxonis-depthai-ros
human_description github-ros4hri-human_description
leo_description github-LeoRover-leo_common-ros2
leo_bringup github-LeoRover-leo_robot-ros2
leo_gz_bringup github-LeoRover-leo_simulator-ros2
mir_description github-DFKI-NI-mir_robot
mir_driver github-DFKI-NI-mir_robot
mir_gazebo github-DFKI-NI-mir_robot
moveit_resources_prbt_moveit_config github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
dual_arm_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
naoqi_driver github-ros-naoqi-naoqi_driver2
raspimouse_description github-rt-net-raspimouse_description
raspimouse_gazebo github-rt-net-raspimouse_sim
turtlebot3_bringup github-ROBOTIS-GIT-turtlebot3
turtlebot3_fake_node github-ROBOTIS-GIT-turtlebot3_simulations
ur_bringup github-UniversalRobots-Universal_Robots_ROS2_Driver
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS2_Driver
urdf_sim_tutorial github-ros-urdf_sim_tutorial
flir_camera_description github-ros-drivers-flir_camera_driver
pmb2_bringup github-pal-robotics-pmb2_robot
crane_plus_description github-rt-net-crane_plus
crane_plus_gazebo github-rt-net-crane_plus
crane_plus_moveit_config github-rt-net-crane_plus
dbw_fca_description bitbucket-dataspeedinc-dbw_ros
dbw_ford_description bitbucket-dataspeedinc-dbw_ros
dbw_polaris_description bitbucket-dataspeedinc-dbw_ros
dummy_robot_bringup github-ros2-demos
open_manipulator_x_description github-dynamixel-community-dynamixel_hardware
pantilt_bot_description github-dynamixel-community-dynamixel_hardware
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
nav2_system_tests github-ros-planning-navigation2
raspimouse_slam github-rt-net-raspimouse_slam_navigation_ros2
sick_safetyscanners2 github-SICKAG-sick_safetyscanners2
sm_dance_bot github-robosoft-ai-SMACC2
sm_dance_bot_warehouse github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_2 github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_3 github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_4 github-robosoft-ai-SMACC2
sm_dancebot_artgallery_ue github-robosoft-ai-SMACC2
sm_dancebot_mine_ue github-robosoft-ai-SMACC2
sm_dancebot_office_ue github-robosoft-ai-SMACC2
sm_dancebot_ue github-robosoft-ai-SMACC2
panda_arm_1_moveit_config github-robosoft-ai-SMACC2
panda_arm_2_moveit_config github-robosoft-ai-SMACC2
sm_panda_moveit2z_cb_inventory github-robosoft-ai-SMACC2
turtlebot3_manipulation_bringup github-ROBOTIS-GIT-turtlebot3_manipulation
turtlebot3_manipulation_description github-ROBOTIS-GIT-turtlebot3_manipulation
turtlebot3_manipulation_moveit_config github-ROBOTIS-GIT-turtlebot3_manipulation
urdf_launch github-ros-urdf_launch
ros_base github-ros2-variants
webots_ros2_epuck github-cyberbotics-webots_ros2
webots_ros2_tiago github-cyberbotics-webots_ros2
webots_ros2_turtlebot github-cyberbotics-webots_ros2
webots_ros2_universal_robot github-cyberbotics-webots_ros2
irobot_create_common_bringup github-iRobotEducation-create3_sim
turtlebot4_description github-turtlebot-turtlebot4
ur_description github-UniversalRobots-Universal_Robots_ROS2_Description
bcr_bot github-blackcoffeerobotics-bcr_bot
gazebo_set_joint_positions_plugin github-Boeing-gazebo_set_joint_positions_plugin
qb_softhand_industry_ros2_control bitbucket-qbrobotics-qbshin-ros
reach_ros github-ros-industrial-reach_ros2
ign_ros2_control_demos github-ros-controls-gz_ros2_control
canopen_tests github-ros-industrial-ros2_canopen
kortex_description github-Kinovarobotics-ros2_kortex
kinova_gen3_6dof_robotiq_2f_85_moveit_config github-Kinovarobotics-ros2_kortex
kinova_gen3_7dof_robotiq_2f_85_moveit_config github-Kinovarobotics-ros2_kortex
robotiq_description github-PickNikRobotics-ros2_robotiq_gripper
ros_gz_sim_demos github-gazebosim-ros_gz
andino_description github-Ekumen-OS-andino
andino_gz_classic github-Ekumen-OS-andino
clearpath_control github-clearpathrobotics-clearpath_common
clearpath_platform_description github-clearpathrobotics-clearpath_common
gazebo_planar_move_plugin github-Boeing-gazebo_planar_move_plugin
omni_base_bringup github-pal-robotics-omni_base_robot
play_motion2 github-pal-robotics-play_motion2
tiago_bringup github-pal-robotics-tiago_robot

Launch files

  • launch/rsp-launch-urdf-inline.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-urdf-file.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-xacro-command-subst.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 3.2.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version iron
Last Updated 2024-02-07
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package take the joint angles of a robot as input, and publishes the 3D poses of the robot links to tf2, using a kinematic tree model of the robot.

Additional Links

No additional links.

Maintainers

  • Chris Lalancette

Authors

  • Karsten Knese
  • Shane Loretz

Robot State Publisher

This package contains the Robot State Publisher, a node and a class to publish the state of a robot to tf2. At startup time, Robot State Publisher is supplied with a kinematic tree model (URDF) of the robot. It then subscribes to the joint_states topic (of type sensor_msgs/msg/JointState) to get individual joint states. These joint states are used to update the kinematic tree model, and the resulting 3D poses are then published to tf2.

Robot State Publisher deals with two different "classes" of joint types: fixed and movable. Fixed joints (with the type "fixed") are published to the transient_local /tf_static topic once on startup (transient_local topics keep a history of what they published, so a later subscription can always get the latest state of the world). Movable joints are published to the regular /tf topic any time the appropriate joint is updated in the joint_states message.

Examples showing how to pass the robot_description parameter using a launch file are available in the 'launch' subdirectory.

Published Topics

  • robot_description (std_msgs/msg/String) - The description of the robot URDF as a string. Republishes the value set in the robot_description parameter, which is useful for getting informed of dynamic changes to the URDF. Published using the "transient local" quality of service, so subscribers should also be "transient local".
  • tf (tf2_msgs/msg/TFMessage) - The transforms corresponding to the movable joints of the robot.
  • tf_static (tf2_msgs/msg/TFMessage) - The transforms corresponding to the static joints of the robot.

Subscribed Topics

  • joint_states (sensor_msgs/msg/JointState) - The joint state updates to the robot poses. The RobotStatePublisher class takes these updates, does transformations (such as mimic joints), and then publishes the results on the tf2 topics.

Parameters

  • robot_description (string) - The original description of the robot in URDF form. This must be set at robot_state_publisher startup time, or the node will fail to start. Updates to this parameter will be reflected in the robot_description topic.
  • publish_frequency (double) - The maximum frequency at which non-static transforms (e.g. joint states) will be published to /tf. Defaults to 20.0 Hz.
  • ignore_timestamp (bool) - Whether to accept all joint states no matter what the timestamp (true), or to only publish joint state updates if they are newer than the last publish_frequency (false). Defaults to false.
  • frame_prefix (string) - An arbitrary prefix to add to the published tf2 frames. Defaults to the empty string.
CHANGELOG

Changelog for package robot_state_publisher

3.2.1 (2024-02-07)

  • Fix reload after a description with a mimic joint (#213)
  • Contributors: Guillaume Doisy

3.2.0 (2023-04-11)

  • Update robot_state_publisher to C++17. (#204)
  • Contributors: Chris Lalancette

3.1.2 (2023-02-13)

  • [rolling] Update maintainers - 2022-11-07 (#203)
  • Contributors: Audrow Nash

3.1.1 (2022-09-13)

  • Mirror rolling to ros2
  • Contributors: Audrow Nash

3.1.0 (2022-05-10)

3.0.2 (2022-04-05)

  • Depend on orocos_kdl_vendor (#191)
  • Contributors: Jacob Perron

3.0.1 (2022-03-28)

  • export dependencies, to use robot_state_publisher as a component (#193)
  • Contributors: Kenji Brameld

3.0.0 (2022-01-14)

  • Fix include order for cpplint (#186)
  • Change how parameter updates are handled (#180)
  • Install includes to instal/\${PROJECT_NAME} (#184)
  • Make the change_fixed_joint test more robust (#183)
  • Add in a test to make sure fixed transforms change on update
  • Small C++ nice-isms in the tests
  • Switch to using target_include_directories for tests
  • Publish new fixed transforms when URDF is updated
  • Make joint_states subscription QoS configurable; default to SensorDataQoS (#179)
  • Remove dependency on urdfdom_headers (#168)
  • Contributors: Anthony Deschamps, Chris Lalancette, Jacob Perron, Russell Joyce, Shane Loretz

2.7.0 (2021-10-18)

  • Fix deprecated subscriber callbacks (#173)
  • Contributors: Abrar Rahman Protyasha

2.6.0 (2021-08-02)

  • Cleanup the documentation in the RobotStatePublisher class. (#172)
  • Always publish fixed frames to /tf_static (#158)
  • corrected publish_frequency default in README (#166)
  • Contributors: Chris Lalancette, Jacob Perron, Nils Schulte

2.5.0 (2021-06-11)

  • Add tf frame_prefix parameter (#159)
  • Contributors: Steve Nogar, Chris Lalancette

2.4.3 (2021-04-19)

  • Stop rejecting unknown parameters. (#161)
  • Contributors: Chris Lalancette

2.4.2 (2021-01-25)

  • clean up license to be standard bsd 3 clause (#130)
  • Update the maintainers. (#151)
  • Contributors: Chris Lalancette, Tully Foote

2.4.1 (2020-09-28)

  • fix types in range loops to avoid copy due to different type (#143)
  • Make sure not to crash on an invalid URDF. (#141)
  • Contributors: Chris Lalancette, Dirk Thomas

2.4.0 (2020-04-30)

  • Replace deprecated launch_ros usage (#137)
  • code style only: wrap after open parenthesis if not in one line (#129)
  • Refactor the ROS 2 code to be more modern (#126)
  • Switch to using TARGET_FILE to find the binary targets on Windows.
  • Fix tests on Windows.
  • Make the error message much nicer on Windows.
  • robot_state_publisher_node -> robot_state_publisher
  • Fix test build on Windows.
  • Get rid of redundant declaration.
  • Guard against negative publish_frequencies.
  • Switch to modern launch_testing ReadyToTest.
  • Add testing to robot_state_publisher.
  • Update some example launch files.
  • Implement the ability to change the parameters on the fly.
  • Fix silly bug while computing the publish interval.
  • Refactor to have a \"setup\" function during the constructor and later on during the parameter setup.
  • Mark things as explicit and final.
  • Update the documentation.
  • Make robot_state_publisher composable.
  • Contributors: Chris Lalancette, Dirk Thomas, Jacob Perron

2.3.1 (2019-10-23)

  • Switch the license back to BSD. (#121)
  • Contributors: Chris Lalancette

2.3.0 (2019-09-26)

  • Install include directories (#31)
  • Publish URDF string on startup (#24)
  • Contributors: Patrick Beeson, Poh Zhi-Ee, Shane Loretz

2.2.4 (2019-09-06)

  • Remove unused Eigen3 dependency (#27) (#29)
  • Don\'t export exe as library (#25) (ros2 #28)
  • Contributors: Shane Loretz

2.2.3 (2019-06-12)

  • Use rclcpp::Time for stamping transforms (#20)
  • Contributors: Scott K Logan

2.2.2 (2019-05-08)

  • changes to avoid deprecated API\'s (#19)
  • Contributors: William Woodall

2.2.1 (2019-04-26)

  • Updated to avoid deprecated API. (#18)
  • Contributors: William Woodall

2.2.0 (2019-04-14)

  • Set urdf content as parameter. (#15)
  • Contributors: Karsten Knese

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cartographer_ros github-ros2-cartographer_ros
depthai_bridge github-luxonis-depthai-ros
depthai_descriptions github-luxonis-depthai-ros
depthai_examples github-luxonis-depthai-ros
leo_description github-LeoRover-leo_common-ros2
leo_bringup github-LeoRover-leo_robot-ros2
mir_description github-DFKI-NI-mir_robot
mir_driver github-DFKI-NI-mir_robot
mir_gazebo github-DFKI-NI-mir_robot
moveit_resources_prbt_moveit_config github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
dual_arm_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
naoqi_driver github-ros-naoqi-naoqi_driver2
turtlebot3_fake_node github-ROBOTIS-GIT-turtlebot3_simulations
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS2_Driver
urdf_sim_tutorial github-ros-urdf_sim_tutorial
flir_camera_description github-ros-drivers-flir_camera_driver
dummy_robot_bringup github-ros2-demos
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
nav2_system_tests github-ros-planning-navigation2
sick_safetyscanners2 github-SICKAG-sick_safetyscanners2
sm_aws_warehouse_navigation github-robosoft-ai-SMACC2
sm_dance_bot github-robosoft-ai-SMACC2
sm_dance_bot_strikes_back github-robosoft-ai-SMACC2
sm_dance_bot_warehouse github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_2 github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_3 github-robosoft-ai-SMACC2
urdf_launch github-ros-urdf_launch
ros_base github-ros2-variants
webots_ros2_epuck github-cyberbotics-webots_ros2
webots_ros2_tiago github-cyberbotics-webots_ros2
webots_ros2_turtlebot github-cyberbotics-webots_ros2
webots_ros2_universal_robot github-cyberbotics-webots_ros2
ur_description github-UniversalRobots-Universal_Robots_ROS2_Description
gz_ros2_control_demos github-ros-controls-gz_ros2_control
gz_ros2_control_tests github-ros-controls-gz_ros2_control
kortex_description github-Kinovarobotics-ros2_kortex
kinova_gen3_6dof_robotiq_2f_85_moveit_config github-Kinovarobotics-ros2_kortex
kinova_gen3_7dof_robotiq_2f_85_moveit_config github-Kinovarobotics-ros2_kortex
robotiq_description github-PickNikRobotics-ros2_robotiq_gripper
ros_gz_sim_demos github-gazebosim-ros_gz

Launch files

  • launch/rsp-launch-urdf-inline.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-urdf-file.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-xacro-command-subst.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 3.3.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version rolling
Last Updated 2024-01-24
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package take the joint angles of a robot as input, and publishes the 3D poses of the robot links to tf2, using a kinematic tree model of the robot.

Additional Links

No additional links.

Maintainers

  • Chris Lalancette

Authors

  • Karsten Knese
  • Shane Loretz

Robot State Publisher

This package contains the Robot State Publisher, a node and a class to publish the state of a robot to tf2. At startup time, Robot State Publisher is supplied with a kinematic tree model (URDF) of the robot. It then subscribes to the joint_states topic (of type sensor_msgs/msg/JointState) to get individual joint states. These joint states are used to update the kinematic tree model, and the resulting 3D poses are then published to tf2.

Robot State Publisher deals with two different "classes" of joint types: fixed and movable. Fixed joints (with the type "fixed") are published to the transient_local /tf_static topic once on startup (transient_local topics keep a history of what they published, so a later subscription can always get the latest state of the world). Movable joints are published to the regular /tf topic any time the appropriate joint is updated in the joint_states message.

Examples showing how to pass the robot_description parameter using a launch file are available in the 'launch' subdirectory.

Published Topics

  • robot_description (std_msgs/msg/String) - The description of the robot URDF as a string. Republishes the value set in the robot_description parameter, which is useful for getting informed of dynamic changes to the URDF. Published using the "transient local" quality of service, so subscribers should also be "transient local".
  • tf (tf2_msgs/msg/TFMessage) - The transforms corresponding to the movable joints of the robot.
  • tf_static (tf2_msgs/msg/TFMessage) - The transforms corresponding to the static joints of the robot.

Subscribed Topics

  • joint_states (sensor_msgs/msg/JointState) - The joint state updates to the robot poses. The RobotStatePublisher class takes these updates, does transformations (such as mimic joints), and then publishes the results on the tf2 topics.

Parameters

  • robot_description (string) - The original description of the robot in URDF form. This must be set at robot_state_publisher startup time, or the node will fail to start. Updates to this parameter will be reflected in the robot_description topic.
  • publish_frequency (double) - The maximum frequency at which non-static transforms (e.g. joint states) will be published to /tf. Defaults to 20.0 Hz.
  • ignore_timestamp (bool) - Whether to accept all joint states no matter what the timestamp (true), or to only publish joint state updates if they are newer than the last publish_frequency (false). Defaults to false.
  • frame_prefix (string) - An arbitrary prefix to add to the published tf2 frames. Defaults to the empty string.
CHANGELOG

Changelog for package robot_state_publisher

3.3.3 (2024-01-24)

  • Fix reload after a description with a mimic joint (#212)
  • Contributors: Guillaume Doisy

3.3.2 (2023-11-06)

  • Remove ament_target_dependencies. (#209)
  • Contributors: Chris Lalancette

3.3.1 (2023-06-07)

  • Improve log messages (#206)
  • Contributors: Nick Lamprianidis

3.3.0 (2023-04-28)

3.2.0 (2023-04-11)

  • Update robot_state_publisher to C++17. (#204)
  • Contributors: Chris Lalancette

3.1.2 (2023-02-13)

  • [rolling] Update maintainers - 2022-11-07 (#203)
  • Contributors: Audrow Nash

3.1.1 (2022-09-13)

  • Mirror rolling to ros2
  • Contributors: Audrow Nash

3.1.0 (2022-05-10)

3.0.2 (2022-04-05)

  • Depend on orocos_kdl_vendor (#191)
  • Contributors: Jacob Perron

3.0.1 (2022-03-28)

  • export dependencies, to use robot_state_publisher as a component (#193)
  • Contributors: Kenji Brameld

3.0.0 (2022-01-14)

  • Fix include order for cpplint (#186)
  • Change how parameter updates are handled (#180)
  • Install includes to instal/\${PROJECT_NAME} (#184)
  • Make the change_fixed_joint test more robust (#183)
  • Add in a test to make sure fixed transforms change on update
  • Small C++ nice-isms in the tests
  • Switch to using target_include_directories for tests
  • Publish new fixed transforms when URDF is updated
  • Make joint_states subscription QoS configurable; default to SensorDataQoS (#179)
  • Remove dependency on urdfdom_headers (#168)
  • Contributors: Anthony Deschamps, Chris Lalancette, Jacob Perron, Russell Joyce, Shane Loretz

2.7.0 (2021-10-18)

  • Fix deprecated subscriber callbacks (#173)
  • Contributors: Abrar Rahman Protyasha

2.6.0 (2021-08-02)

  • Cleanup the documentation in the RobotStatePublisher class. (#172)
  • Always publish fixed frames to /tf_static (#158)
  • corrected publish_frequency default in README (#166)
  • Contributors: Chris Lalancette, Jacob Perron, Nils Schulte

2.5.0 (2021-06-11)

  • Add tf frame_prefix parameter (#159)
  • Contributors: Steve Nogar, Chris Lalancette

2.4.3 (2021-04-19)

  • Stop rejecting unknown parameters. (#161)
  • Contributors: Chris Lalancette

2.4.2 (2021-01-25)

  • clean up license to be standard bsd 3 clause (#130)
  • Update the maintainers. (#151)
  • Contributors: Chris Lalancette, Tully Foote

2.4.1 (2020-09-28)

  • fix types in range loops to avoid copy due to different type (#143)
  • Make sure not to crash on an invalid URDF. (#141)
  • Contributors: Chris Lalancette, Dirk Thomas

2.4.0 (2020-04-30)

  • Replace deprecated launch_ros usage (#137)
  • code style only: wrap after open parenthesis if not in one line (#129)
  • Refactor the ROS 2 code to be more modern (#126)
  • Switch to using TARGET_FILE to find the binary targets on Windows.
  • Fix tests on Windows.
  • Make the error message much nicer on Windows.
  • robot_state_publisher_node -> robot_state_publisher
  • Fix test build on Windows.
  • Get rid of redundant declaration.
  • Guard against negative publish_frequencies.
  • Switch to modern launch_testing ReadyToTest.
  • Add testing to robot_state_publisher.
  • Update some example launch files.
  • Implement the ability to change the parameters on the fly.
  • Fix silly bug while computing the publish interval.
  • Refactor to have a \"setup\" function during the constructor and later on during the parameter setup.
  • Mark things as explicit and final.
  • Update the documentation.
  • Make robot_state_publisher composable.
  • Contributors: Chris Lalancette, Dirk Thomas, Jacob Perron

2.3.1 (2019-10-23)

  • Switch the license back to BSD. (#121)
  • Contributors: Chris Lalancette

2.3.0 (2019-09-26)

  • Install include directories (#31)
  • Publish URDF string on startup (#24)
  • Contributors: Patrick Beeson, Poh Zhi-Ee, Shane Loretz

2.2.4 (2019-09-06)

  • Remove unused Eigen3 dependency (#27) (#29)
  • Don\'t export exe as library (#25) (ros2 #28)
  • Contributors: Shane Loretz

2.2.3 (2019-06-12)

  • Use rclcpp::Time for stamping transforms (#20)
  • Contributors: Scott K Logan

2.2.2 (2019-05-08)

  • changes to avoid deprecated API\'s (#19)
  • Contributors: William Woodall

2.2.1 (2019-04-26)

  • Updated to avoid deprecated API. (#18)
  • Contributors: William Woodall

2.2.0 (2019-04-14)

  • Set urdf content as parameter. (#15)
  • Contributors: Karsten Knese

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cartographer_ros github-ros2-cartographer_ros
leo_description github-LeoRover-leo_common-ros2
leo_bringup github-LeoRover-leo_robot-ros2
mir_description github-DFKI-NI-mir_robot
mir_driver github-DFKI-NI-mir_robot
mir_gazebo github-DFKI-NI-mir_robot
moveit_resources_prbt_moveit_config github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
dual_arm_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
turtlebot3_fake_node github-ROBOTIS-GIT-turtlebot3_simulations
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS2_Driver
flir_camera_description github-ros-drivers-flir_camera_driver
dummy_robot_bringup github-ros2-demos
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
sm_aws_warehouse_navigation github-robosoft-ai-SMACC2
sm_dance_bot github-robosoft-ai-SMACC2
sm_dance_bot_strikes_back github-robosoft-ai-SMACC2
sm_dance_bot_warehouse github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_2 github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_3 github-robosoft-ai-SMACC2
urdf_launch github-ros-urdf_launch
ros_base github-ros2-variants
webots_ros2_epuck github-cyberbotics-webots_ros2
webots_ros2_tiago github-cyberbotics-webots_ros2
webots_ros2_turtlebot github-cyberbotics-webots_ros2
webots_ros2_universal_robot github-cyberbotics-webots_ros2
ur_description github-UniversalRobots-Universal_Robots_ROS2_Description
reach_ros github-ros-industrial-reach_ros2
gz_ros2_control_demos github-ros-controls-gz_ros2_control
gz_ros2_control_tests github-ros-controls-gz_ros2_control
canopen_tests github-ros-industrial-ros2_canopen
kortex_description github-Kinovarobotics-ros2_kortex
kinova_gen3_6dof_robotiq_2f_85_moveit_config github-Kinovarobotics-ros2_kortex
kinova_gen3_7dof_robotiq_2f_85_moveit_config github-Kinovarobotics-ros2_kortex
robotiq_description github-PickNikRobotics-ros2_robotiq_gripper
ros_gz_sim_demos github-gazebosim-ros_gz

Launch files

  • launch/rsp-launch-urdf-inline.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-urdf-file.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-xacro-command-subst.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 1.15.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version noetic-devel
Last Updated 2023-10-30
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

Maintainers

  • Chris Lalancette
  • Ian McMahon
  • Shane Loretz

Authors

  • Ioan Sucan
  • Jackie Kay
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package robot_state_publisher

1.15.2 (2021-09-30)

  • Reimplement tf_prefix in Noetic exactly as it was in Melodic (#169)
  • Include joint_states_index.bag in repo (#176)
  • Contributors: Shane Loretz

1.15.1 (2020-04-24)

1.15.0 (2020-04-17)

  • Remove state_publisher and add in a public default constructor (#87)
  • Added support for custom RobotStatePublisher implementations (API/ABI break) (#115)
  • Bump CMake version to avoid CMP0048 (#136)
  • Add missing test depend rosbag (#135)
  • Used orocos keys (#134)
  • Add joint_state_listener to the catkin package LIBRARIES (#112) (#114)
  • Make sure to make sensor_msgs a catkin dependency. (#122)
  • update how compiler flags are added (#104)
  • update install destination in CMakeLists.txt (#103)
  • Remove treefksolver completely from the repository. (#100)
  • changed return code from -1 to 1 since its considered a reserved bash exit code (#98)
  • Fixed problem when building static library version (#92) (#96)
  • Add Ian as a maintainer for robot_state_publisher. (#94)
  • added warning when joint is found in joint message but not in the urdf (#83)
  • added ros_warn if JointStateMessage is older than 30 seconds (#84)
  • Add tcp_no_delay to joint_states subscriber (#80) (#85)
  • Remove dependency on tf and tf_prefix support (#82)
  • make rostest in CMakeLists optional (ros/rosdistro#3010) (#75)
  • Added c++11 target_compile_options (#78)
  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
audibot_gazebo github-robustify-audibot
cob_cartesian_controller github-4am-robotics-cob_control
cob_obstacle_distance github-4am-robotics-cob_control
cob_twist_controller github-4am-robotics-cob_control
cob_grasp_generation github-ipa320-cob_manipulation
cob_moveit_bringup github-ipa320-cob_manipulation
cob_bringup github-ipa320-cob_robots
cob_hardware_config github-ipa320-cob_robots
cob_gazebo_worlds github-ipa320-cob_simulation
crane_x7_moveit_config github-rt-net-crane_x7_ros
create_description github-AutonomyLab-create_robot
dbw_fca_description bitbucket-DataspeedInc-dbw_fca_ros
dbw_mkz_description bitbucket-dataspeedinc-dbw_mkz_ros
dbw_polaris_description bitbucket-DataspeedInc-dbw_polaris_ros
depthai_bridge github-luxonis-depthai-ros
depthai_descriptions github-luxonis-depthai-ros
depthai_examples github-luxonis-depthai-ros
dingo_description github-dingo-cpr-dingo
dynamic_robot_state_publisher github-peci1-dynamic_robot_state_publisher
ensenso_camera github-ensenso-ros_driver
exotica_examples github-ipab-slmc-exotica
fetch_bringup github-fetchrobotics-fetch_robots
freight_bringup github-fetchrobotics-fetch_robots
fetch_moveit_config github-fetchrobotics-fetch_ros
franka_control github-frankaemika-franka_ros
husky_control github-husky-husky
husky_viz github-husky-husky
industrial_robot_client github-ros-industrial-industrial_core
jackal_description github-jackal-jackal
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
pr2eus github-jsk-ros-pkg-jsk_pr2eus
pr2eus_openrave github-jsk-ros-pkg-jsk_pr2eus
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
khi_duaro_moveit_config github-Kawasaki-Robotics-khi_robot
khi_robot_bringup github-Kawasaki-Robotics-khi_robot
khi_rs007l_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs007n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs013n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs020n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs025n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs030n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs080n_moveit_config github-Kawasaki-Robotics-khi_robot
leo_description github-LeoRover-leo_common
leo_viz github-LeoRover-leo_desktop
leo_bringup github-LeoRover-leo_robot
leo_gazebo github-LeoRover-leo_simulator
robot github-ros-metapackages
mir_description github-DFKI-NI-mir_robot
mir_driver github-DFKI-NI-mir_robot
mir_gazebo github-DFKI-NI-mir_robot
moveit_resources_dual_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_prbt_moveit_config github-ros-planning-moveit_resources
multisense_bringup github-carnegierobotics-multisense_ros
naoqi_driver github-ros-naoqi-naoqi_driver
panda_moveit_config github-ros-planning-panda_moveit_config
pass_through_controllers github-UniversalRobots-Universal_Robots_ROS_passthrough_controllers
pf_description github-PepperlFuchs-pf_lidar_ros_driver
prbt_moveit_config github-PilzDE-pilz_robots
prbt_support github-PilzDE-pilz_robots
pincher_arm_bringup github-fictionlab-pincher_arm
pincher_arm_moveit_config github-fictionlab-pincher_arm
pointgrey_camera_description github-ros-drivers-pointgrey_camera_driver
pr2_bringup github-pr2-pr2_robot
pr2_gazebo github-PR2-pr2_simulator
psen_scan_v2 github-PilzDE-psen_scan_v2
raspimouse_description github-rt-net-raspimouse_description
ridgeback_description github-ridgeback-ridgeback
robotont_description github-robotont-robotont_description
effort_controllers github-ros-controls-ros_controllers
cartesian_trajectory_controller github-UniversalRobots-Universal_Robots_ROS_controllers_cartesian
schunk_svh_driver github-SCHUNK-GmbH-Co-KG-schunk_svh_ros_driver
sciurus17_moveit_config github-rt-net-sciurus17_ros
sick_ldmrs_description github-SICKAG-sick_ldmrs_laser
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_tim github-uos-sick_tim
turtlebot3_bringup github-ROBOTIS-GIT-turtlebot3
turtlebot3_fake github-ROBOTIS-GIT-turtlebot3_simulations
ur10_moveit_config github-ros-industrial-universal_robot
ur10e_moveit_config github-ros-industrial-universal_robot
ur16e_moveit_config github-ros-industrial-universal_robot
ur20_moveit_config github-ros-industrial-universal_robot
ur30_moveit_config github-ros-industrial-universal_robot
ur3_moveit_config github-ros-industrial-universal_robot
ur3e_moveit_config github-ros-industrial-universal_robot
ur5_moveit_config github-ros-industrial-universal_robot
ur5e_moveit_config github-ros-industrial-universal_robot
ur_description github-ros-industrial-universal_robot
ur_gazebo github-ros-industrial-universal_robot
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS_Driver
urdf_sim_tutorial github-ros-urdf_sim_tutorial
urdf_tutorial github-ros-urdf_tutorial
rwt_moveit github-tork-a-visualization_rwt
warthog_description github-warthog-cpr-warthog
webots_ros github-cyberbotics-webots_ros
xpp_vis github-leggedrobotics-xpp
flir_camera_description github-ros-drivers-flir_camera_driver
bcr_bot github-blackcoffeerobotics-bcr_bot
diffbot_control github-ros-mobile-robots-diffbot
diffbot_description github-ros-mobile-robots-diffbot
mia_hand_description bitbucket-prensiliasrl-mia_hand_ros_pkgs
mia_hand_moveit_config bitbucket-prensiliasrl-mia_hand_ros_pkgs
reach_ros github-ros-industrial-reach_ros
thunder_line_follower_pmr3100 github-ThundeRatz-thunder_line_follower_pmr3100

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 2.0.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/robot_state_publisher.git
VCS Type git
VCS Version ardent
Last Updated 2017-12-09
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

ROS2 version of the robot_state_publisher package

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.

ROS2 Version of Robot State Publisher

This package contains a forked version of the original ROS Robot State Publisher with all modifications to compile within a ROS2 Ecosystem.

CHANGELOG

Changelog for package robot_state_publisher

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 2.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/robot_state_publisher.git
VCS Type git
VCS Version bouncy
Last Updated 2018-06-27
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

ROS2 version of the robot_state_publisher package

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.

ROS2 Version of Robot State Publisher

This package contains a forked version of the original ROS Robot State Publisher with all modifications to compile within a ROS2 Ecosystem.

CHANGELOG

Changelog for package robot_state_publisher

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 2.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version crystal
Last Updated 2018-06-27
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

ROS2 version of the robot_state_publisher package

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.

ROS2 Version of Robot State Publisher

This package contains a forked version of the original ROS Robot State Publisher with all modifications to compile within a ROS2 Ecosystem.

CHANGELOG

Changelog for package robot_state_publisher

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 2.3.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version eloquent
Last Updated 2019-10-23
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

ROS2 version of the robot_state_publisher package

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.

ROS2 Version of Robot State Publisher

This package contains a forked version of the original ROS Robot State Publisher with all modifications to compile within a ROS2 Ecosystem.

CHANGELOG

Changelog for package robot_state_publisher

2.3.1 (2019-10-23)

  • Switch the license back to BSD. (#121)
  • Contributors: Chris Lalancette

2.3.0 (2019-09-26)

  • Install include directories (#31)
  • Publish URDF string on startup (#24)
  • Contributors: Patrick Beeson, Poh Zhi-Ee, Shane Loretz

2.2.4 (2019-09-06)

  • Remove unused Eigen3 dependency (#27) (#29)
  • Don\'t export exe as library (#25) (#28)
  • Contributors: Shane Loretz

2.2.3 (2019-06-12)

  • Use rclcpp::Time for stamping transforms (#20)
  • Contributors: Scott K Logan

2.2.2 (2019-05-08)

  • changes to avoid deprecated API\'s (#19)
  • Contributors: William Woodall

2.2.1 (2019-04-26)

  • Updated to avoid deprecated API. (#18)
  • Contributors: William Woodall

2.2.0 (2019-04-14)

  • Set urdf content as parameter. (#15)
  • Contributors: Karsten Knese

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 2.2.5
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version dashing
Last Updated 2019-12-04
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

ROS2 version of the robot_state_publisher package

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.

ROS2 Version of Robot State Publisher

This package contains a forked version of the original ROS Robot State Publisher with all modifications to compile within a ROS2 Ecosystem.

CHANGELOG

Changelog for package robot_state_publisher

2.2.5 (2019-12-04)

  • Publish description right away (#124)
  • Contributors: Shane Loretz

2.2.4 (2019-09-06)

  • Remove unused Eigen3 dependency (#27) (#29)
  • Don\'t export exe as library (#25) (#28)
  • Contributors: Shane Loretz

2.2.3 (2019-06-12)

  • Use rclcpp::Time for stamping transforms (#20)
  • Contributors: Scott K Logan

2.2.2 (2019-05-08)

  • changes to avoid deprecated API\'s (#19)
  • Contributors: William Woodall

2.2.1 (2019-04-26)

  • Updated to avoid deprecated API. (#18)
  • Contributors: William Woodall

2.2.0 (2019-04-14)

  • Set urdf content as parameter. (#15)
  • Contributors: Karsten Knese

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 2.5.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version galactic
Last Updated 2022-02-17
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

No additional links.

Maintainers

  • Chris Lalancette
  • Shane Loretz

Authors

  • Karsten Knese

Robot State Publisher

This package contains the Robot State Publisher, a node and a class to publish the state of a robot to tf2. Once the state gets published, it is available to all components in the system that also use tf2. The package takes the joint angles of the robot as input and publishes the 3D poses of the robot links, using a kinematic tree model of the robot.

Examples showing how to pass the robot_description parameter using a launch file are available in the 'launch' subdirectory.

Published Topics

  • robot_description (std_msgs/msg/String) - The description of the robot URDF as a string. Republishes the value set in the robot_description parameter, which is useful for getting informed of dynamic changes to the URDF. Published using the "transient local" quality of service, so subscribers should also be "transient local".
  • tf (tf2_msgs/msg/TFMessage) - The transforms corresponding to the movable joints of the robot.
  • tf_static (tf2_msgs/msg/TFMessage) - The transforms corresponding to the static joints of the robot.

Subscribed Topics

  • joint_states (sensor_msgs/msg/JointState) - The joint state updates to the robot poses. The RobotStatePublisher class takes these updates, does transformations (such as mimic joints), and then publishes the results on the tf2 topics.

Parameters

  • robot_description (string) - The original description of the robot in URDF form. This must be set at robot_state_publisher startup time, or the node will fail to start. Updates to this parameter will be reflected in the robot_description topic.
  • publish_frequency (double) - The frequency at which fixed transforms will be republished to the network. Defaults to 50.0.
  • use_tf_static (bool) - Whether to publish fixed joints on the static broadcaster (/tf_static topic) or on the dynamic one (/tf topic). Defaults to true, so it publishes on the /tf_static topic.
  • ignore_timestamp (bool) - Whether to accept all joint states no matter what the timestamp (true), or to only publish joint state updates if they are newer than the last publish_frequency (false). Defaults to false.
  • frame_prefix (string) - An arbitrary prefix to add to the published tf2 frames. Defaults to the empty string.
CHANGELOG

Changelog for package robot_state_publisher

2.5.3 (2022-02-17)

  • Publish new fixed transforms when URDF is updated (#189)
  • Contributors: Chris Lalancette

2.5.2 (2021-11-30)

  • Prevent robot_state_publisher from publishing on a timer (#175)
  • Contributors: Daisuke Nishimatsu

2.5.1 (2021-08-04)

2.4.4 (2021-08-02)

  • Restore tf frame prefix support for ROS 2 (#159) (#171)
  • Contributors: Chris Lalancette

2.4.3 (2021-04-19)

  • Stop rejecting unknown parameters. (#161)
  • Contributors: Chris Lalancette

2.4.2 (2021-01-25)

  • clean up license to be standard bsd 3 clause (#130)
  • Update the maintainers. (#151)
  • Contributors: Chris Lalancette, Tully Foote

2.4.1 (2020-09-28)

  • fix types in range loops to avoid copy due to different type (#143)
  • Make sure not to crash on an invalid URDF. (#141)
  • Contributors: Chris Lalancette, Dirk Thomas

2.4.0 (2020-04-30)

  • Replace deprecated launch_ros usage (#137)
  • code style only: wrap after open parenthesis if not in one line (#129)
  • Refactor the ROS 2 code to be more modern (#126)
  • Switch to using TARGET_FILE to find the binary targets on Windows.
  • Fix tests on Windows.
  • Make the error message much nicer on Windows.
  • robot_state_publisher_node -> robot_state_publisher
  • Fix test build on Windows.
  • Get rid of redundant declaration.
  • Guard against negative publish_frequencies.
  • Switch to modern launch_testing ReadyToTest.
  • Add testing to robot_state_publisher.
  • Update some example launch files.
  • Implement the ability to change the parameters on the fly.
  • Fix silly bug while computing the publish interval.
  • Refactor to have a \"setup\" function during the constructor and later on during the parameter setup.
  • Mark things as explicit and final.
  • Update the documentation.
  • Make robot_state_publisher composable.
  • Contributors: Chris Lalancette, Dirk Thomas, Jacob Perron

2.3.1 (2019-10-23)

  • Switch the license back to BSD. (#121)
  • Contributors: Chris Lalancette

2.3.0 (2019-09-26)

  • Install include directories (#31)
  • Publish URDF string on startup (#24)
  • Contributors: Patrick Beeson, Poh Zhi-Ee, Shane Loretz

2.2.4 (2019-09-06)

  • Remove unused Eigen3 dependency (#27) (#29)
  • Don\'t export exe as library (#25) (ros2 #28)
  • Contributors: Shane Loretz

2.2.3 (2019-06-12)

  • Use rclcpp::Time for stamping transforms (#20)
  • Contributors: Scott K Logan

2.2.2 (2019-05-08)

  • changes to avoid deprecated API\'s (#19)
  • Contributors: William Woodall

2.2.1 (2019-04-26)

  • Updated to avoid deprecated API. (#18)
  • Contributors: William Woodall

2.2.0 (2019-04-14)

  • Set urdf content as parameter. (#15)
  • Contributors: Karsten Knese

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
depthai_bridge github-luxonis-depthai-ros
depthai_examples github-luxonis-depthai-ros
mir_description github-dfki-ric-mir_robot
mir_driver github-dfki-ric-mir_robot
mir_gazebo github-dfki-ric-mir_robot
moveit_resources_prbt_moveit_config github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
dual_arm_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
naoqi_driver github-ros-naoqi-naoqi_driver2
turtlebot3_bringup github-ROBOTIS-GIT-turtlebot3
turtlebot3_fake_node github-ROBOTIS-GIT-turtlebot3_simulations
ur_bringup github-UniversalRobots-Universal_Robots_ROS2_Driver
dummy_robot_bringup github-ros2-demos
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
ign_ros2_control_demos github-ignitionrobotics-ign_ros2_control
nav2_system_tests github-ros-planning-navigation2
ros_ign_gazebo_demos github-ignitionrobotics-ros_ign
sick_safetyscanners2 github-SICKAG-sick_safetyscanners2
sm_dance_bot github-robosoft-ai-SMACC2
sm_dance_bot_strikes_back github-robosoft-ai-SMACC2
sm_dance_bot_warehouse github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_2 github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_3 github-robosoft-ai-SMACC2
ros_base github-ros2-variants
webots_ros2_epuck github-cyberbotics-webots_ros2
webots_ros2_tiago github-cyberbotics-webots_ros2
webots_ros2_turtlebot github-cyberbotics-webots_ros2
webots_ros2_universal_robot github-cyberbotics-webots_ros2
irobot_create_common_bringup github-iRobotEducation-create3_sim
turtlebot4_description github-turtlebot-turtlebot4
ur_description github-UniversalRobots-Universal_Robots_ROS2_Description

Launch files

  • launch/rsp-launch-urdf-inline.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-urdf-file.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-xacro-command-subst.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 2.4.5
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version foxy
Last Updated 2021-08-04
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

No additional links.

Maintainers

  • Chris Lalancette
  • Shane Loretz

Authors

  • Karsten Knese

Robot State Publisher

This package contains the Robot State Publisher, a node and a class to publish the state of a robot to tf2. Once the state gets published, it is available to all components in the system that also use tf2. The package takes the joint angles of the robot as input and publishes the 3D poses of the robot links, using a kinematic tree model of the robot.

Examples showing how to pass the robot_description parameter using a launch file are available in the 'launch' subdirectory.

Published Topics

  • robot_description (std_msgs/msg/String) - The description of the robot URDF as a string. Republishes the value set in the robot_description parameter, which is useful for getting informed of dynamic changes to the URDF. Published using the "transient local" quality of service, so subscribers should also be "transient local".
  • tf (tf2_msgs/msg/TFMessage) - The transforms corresponding to the movable joints of the robot.
  • tf_static (tf2_msgs/msg/TFMessage) - The transforms corresponding to the static joints of the robot.

Subscribed Topics

  • joint_states (sensor_msgs/msg/JointState) - The joint state updates to the robot poses. The RobotStatePublisher class takes these updates, does transformations (such as mimic joints), and then publishes the results on the tf2 topics.

Parameters

  • robot_description (string) - The original description of the robot in URDF form. This must be set at robot_state_publisher startup time, or the node will fail to start. Updates to this parameter will be reflected in the robot_description topic.
  • publish_frequency (double) - The frequency at which fixed transforms will be republished to the network. Defaults to 50.0.
  • use_tf_static (bool) - Whether to publish fixed joints on the static broadcaster (/tf_static topic) or on the dynamic one (/tf topic). Defaults to true, so it publishes on the /tf_static topic.
  • ignore_timestamp (bool) - Whether to accept all joint states no matter what the timestamp (true), or to only publish joint state updates if they are newer than the last publish_frequency (false). Defaults to false.
  • frame_prefix (string) - An arbitrary prefix to add to the published tf2 frames. Defaults to the empty string.
CHANGELOG

Changelog for package robot_state_publisher

2.4.5 (2021-08-04)

  • Restore tf frame prefix support for ROS 2 (#159) (#170)
  • Contributors: Chris Lalancette

2.4.2 (2021-01-25)

  • clean up license to be standard bsd 3 clause (#130)
  • Update the maintainers. (#151)
  • Contributors: Chris Lalancette, Tully Foote

2.4.1 (2020-09-28)

  • fix types in range loops to avoid copy due to different type (#143)
  • Make sure not to crash on an invalid URDF. (#141)
  • Contributors: Chris Lalancette, Dirk Thomas

2.4.0 (2020-04-30)

  • Replace deprecated launch_ros usage (#137)
  • code style only: wrap after open parenthesis if not in one line (#129)
  • Refactor the ROS 2 code to be more modern (#126)
  • Switch to using TARGET_FILE to find the binary targets on Windows.
  • Fix tests on Windows.
  • Make the error message much nicer on Windows.
  • robot_state_publisher_node -> robot_state_publisher
  • Fix test build on Windows.
  • Get rid of redundant declaration.
  • Guard against negative publish_frequencies.
  • Switch to modern launch_testing ReadyToTest.
  • Add testing to robot_state_publisher.
  • Update some example launch files.
  • Implement the ability to change the parameters on the fly.
  • Fix silly bug while computing the publish interval.
  • Refactor to have a \"setup\" function during the constructor and later on during the parameter setup.
  • Mark things as explicit and final.
  • Update the documentation.
  • Make robot_state_publisher composable.
  • Contributors: Chris Lalancette, Dirk Thomas, Jacob Perron

2.3.1 (2019-10-23)

  • Switch the license back to BSD. (#121)
  • Contributors: Chris Lalancette

2.3.0 (2019-09-26)

  • Install include directories (#31)
  • Publish URDF string on startup (#24)
  • Contributors: Patrick Beeson, Poh Zhi-Ee, Shane Loretz

2.2.4 (2019-09-06)

  • Remove unused Eigen3 dependency (#27) (#29)
  • Don\'t export exe as library (#25) (ros2 #28)
  • Contributors: Shane Loretz

2.2.3 (2019-06-12)

  • Use rclcpp::Time for stamping transforms (#20)
  • Contributors: Scott K Logan

2.2.2 (2019-05-08)

  • changes to avoid deprecated API\'s (#19)
  • Contributors: William Woodall

2.2.1 (2019-04-26)

  • Updated to avoid deprecated API. (#18)
  • Contributors: William Woodall

2.2.0 (2019-04-14)

  • Set urdf content as parameter. (#15)
  • Contributors: Karsten Knese

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)
  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
create_description github-AutonomyLab-create_robot
depthai_bridge github-luxonis-depthai-ros
depthai_descriptions github-luxonis-depthai-ros
depthai_examples github-luxonis-depthai-ros
husky_control github-husky-husky
husky_viz github-husky-husky
jackal_control github-jackal-jackal
jackal_description github-jackal-jackal
leo_description github-LeoRover-leo_common-ros2
mir_description github-DFKI-NI-mir_robot
mir_driver github-DFKI-NI-mir_robot
mir_gazebo github-DFKI-NI-mir_robot
moveit_resources_prbt_moveit_config github-ros-planning-moveit2
moveit_hybrid_planning github-ros-planning-moveit2
moveit_servo github-ros-planning-moveit2
dual_arm_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
naoqi_driver github-ros-naoqi-naoqi_driver2
psen_scan_v2 github-PilzDE-psen_scan_v2
raspimouse_description github-rt-net-raspimouse_description
turtlebot3_bringup github-ROBOTIS-GIT-turtlebot3
turtlebot3_fake_node github-ROBOTIS-GIT-turtlebot3_simulations
ur_bringup github-UniversalRobots-Universal_Robots_ROS2_Driver
ur_description github-UniversalRobots-Universal_Robots_ROS2_Driver
pmb2_bringup github-pal-robotics-pmb2_robot
crane_plus_description github-rt-net-crane_plus
crane_plus_ignition github-rt-net-crane_plus
crane_plus_moveit_config github-rt-net-crane_plus
dbw_fca_description bitbucket-dataspeedinc-dbw_ros
dbw_ford_description bitbucket-dataspeedinc-dbw_ros
dbw_polaris_description bitbucket-dataspeedinc-dbw_ros
dummy_robot_bringup github-ros2-demos
open_manipulator_x_description github-dynamixel-community-dynamixel_hardware
pantilt_bot_description github-dynamixel-community-dynamixel_hardware
dynamixel_hardware_interface github-OUXT-Polaris-dynamixel_hardware_interface
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
ign_ros2_control_demos github-ignitionrobotics-ign_ros2_control
nav2_system_tests github-ros-planning-navigation2
raspimouse_slam github-rt-net-raspimouse_slam_navigation_ros2
ros_ign_gazebo_demos github-ignitionrobotics-ros_ign
sick_safetyscanners2 github-SICKAG-sick_safetyscanners2
turtlebot3_manipulation_bringup github-ROBOTIS-GIT-turtlebot3_manipulation
turtlebot3_manipulation_description github-ROBOTIS-GIT-turtlebot3_manipulation
turtlebot3_manipulation_moveit_config github-ROBOTIS-GIT-turtlebot3_manipulation
urdf_launch github-MetroRobots-urdf_launch
ros_base github-ros2-variants
webots_ros2_epuck github-cyberbotics-webots_ros2
webots_ros2_tiago github-cyberbotics-webots_ros2
webots_ros2_turtlebot github-cyberbotics-webots_ros2
webots_ros2_universal_robot github-cyberbotics-webots_ros2
xacro_live github-orise-robotics-xacro_live

Launch files

  • launch/rsp-launch-urdf-inline.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-urdf-file.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
  • launch/rsp-launch-xacro-command-subst.xml
    • Copyright (c) 2020 Open Source Robotics Foundation, Inc. Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: * Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission. THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 1.13.7
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2019-08-27
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

Maintainers

  • Chris Lalancette
  • Ian McMahon
  • Shane Loretz

Authors

  • Ioan Sucan
  • Jackie Kay
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package robot_state_publisher

1.13.7 (2019-08-27)

  • Remove treefksolver completely from the repository. (#100) (#101)
  • Add Ian as a maintainer for robot_state_publisher (#95)
  • Fixed problem when building static library version (#92)
  • Contributors: Chris Lalancette, Shane Loretz, ivanpauno

1.13.6 (2018-04-05)

  • added warning when joint is found in joint message but not in the urdf (#83)
  • added ros_warn if JointStateMessage is older than 30 seconds (#84)
  • Add tcp_no_delay to joint_states subscriber (#80)
  • make rostest in CMakeLists optional (ros/rosdistro#3010) (#75)
  • Added c++11 target_compile_options (#78)
  • Contributors: Lukas Bulwahn, Shane Loretz, Victor Lopez, jgueldenstein

1.13.5 (2017-04-11)

  • Style cleanup throughout the tree.
  • add Chris and Shane as maintainers (#70)
  • Contributors: Chris Lalancette, William Woodall

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cartographer_ros github-googlecartographer-cartographer_ros
desistek_saga_description github-uuvsimulator-desistek_saga
dynamic_robot_state_publisher github-peci1-dynamic_robot_state_publisher
eca_a9_description github-uuvsimulator-eca_a9
ensenso_camera github-ensenso-ros_driver
franka_control github-frankaemika-franka_ros
panda_moveit_config github-frankaemika-franka_ros
lauv_description github-uuvsimulator-lauv_gazebo
robot github-ros-metapackages
mir_description github-dfki-ric-mir_robot
mir_driver github-dfki-ric-mir_robot
mir_gazebo github-dfki-ric-mir_robot
moveit_resources_dual_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_prbt_moveit_config github-ros-planning-moveit_resources
pointgrey_camera_description github-ros-drivers-pointgrey_camera_driver
pr2_gazebo github-PR2-pr2_simulator
rexrov2_description github-uuvsimulator-rexrov2
sick_ldmrs_description github-SICKAG-sick_ldmrs_laser
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_tim github-uos-sick_tim
urdf_tutorial github-ros-urdf_tutorial
uuv_thruster_manager github-uuvsimulator-uuv_simulator
uuv_descriptions github-uuvsimulator-uuv_simulator
xpp_vis github-leggedrobotics-xpp
ca_description github-AutonomyLab-create_autonomy
dynpick_driver github-tork-a-dynpick_driver
katana_arm_gazebo github-uos-katana_driver

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 1.12.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version jade-devel
Last Updated 2017-02-23
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

Maintainers

  • Chris Lalancette
  • Shane Loretz

Authors

  • Ioan Sucan
  • Jackie Kay
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package robot_state_publisher

1.12.2 (2016-05-20)

  • Add back future dating for robot_state_publisher (#49)
  • Restore default argument of tf_static
  • Contributors: Jackie Kay

1.12.1 (2016-02-22)

  • Merge pull request #42 from ros/fix_tests_jade Fix tests for Jade
  • Correct failing tests
  • Re-enabling rostests
  • Merge pull request #39 from scpeters/issue_38
  • Fix API break in publishFixedTransforms A bool argument was added to RobotStatePublisher::publishFixedTransforms which broke API. I\'ve added a default value of false, to match the default specified in the JointStateListener constructor.
  • Contributors: Jackie Kay, Jonathan Bohren, Steven Peters

1.12.0 (2015-10-21)

  • Merge pull request #37 from clearpathrobotics/static-default Publish fixed joints over tf_static by default
  • Merge pull request #34 from ros/tf2-static-jade Port to tf2 and enable using static broadcaster
  • Merge pull request #32 from shadow-robot/fix_issue#19 Check URDF to distinguish fixed joints from floating joints. Floating joint are ignored by the publisher.
  • Merge pull request #26 from xqms/remove-debug get rid of argv[0] debug output on startup
  • Contributors: David Lu!!, Ioan A Sucan, Jackie Kay, Max Schwarz, Paul Bovbel, Toni Oliver

1.11.1 (2016-02-22)

  • Merge pull request #41 from ros/fix_tests_indigo Re-enable and clean up rostests
  • Correct failing tests
  • Re-enabling rostests
  • Fix API break in publishFixedTransforms A bool argument was added to RobotStatePublisher::publishFixedTransforms which broke API. I\'ve added a default value of false, to match the default specified in the JointStateListener constructor.
  • Contributors: Jackie Kay, Jonathan Bohren, Steven Peters

1.11.0 (2015-10-21)

  • Merge pull request #28 from clearpathrobotics/tf2-static

1.10.4 (2014-11-30)

  • Merge pull request #21 from rcodddow/patch-1
  • Fix for joint transforms not being published anymore after a clock reset (e.g. when playing a bagfile and looping)
  • Contributors: Ioan A Sucan, Robert Codd-Downey, Timm Linder

1.10.3 (2014-07-24)

  • add version depend on orocos_kdl >= 1.3.0 Conflicts: package.xml
  • Update KDL SegmentMap interface to optionally use shared pointers The KDL Tree API optionally uses shared pointers on platforms where the STL containers don\'t support incomplete types.
  • Contributors: Brian Jensen, William Woodall

1.10.0 (2014-03-03)

  • minor style fixes
  • Add support for mimic tag.
  • Contributors: Ioan Sucan, Konrad Banachowicz

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
fanuc_cr35ia_support github-ros-industrial-fanuc
fanuc_cr7ia_moveit_config github-ros-industrial-fanuc
fanuc_cr7ia_support github-ros-industrial-fanuc
fanuc_cr7ial_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200i_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200i_support github-ros-industrial-fanuc
fanuc_lrmate200ib3l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ib_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ib_support github-ros-industrial-fanuc
fanuc_lrmate200ic5h_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic5l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_support github-ros-industrial-fanuc
fanuc_m10ia_moveit_config github-ros-industrial-fanuc
fanuc_m10ia_support github-ros-industrial-fanuc
fanuc_m16ib20_moveit_config github-ros-industrial-fanuc
fanuc_m16ib_support github-ros-industrial-fanuc
fanuc_m20ia10l_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_support github-ros-industrial-fanuc
fanuc_m20ib25_moveit_config github-ros-industrial-fanuc
fanuc_m20ib_support github-ros-industrial-fanuc
fanuc_m430ia2f_moveit_config github-ros-industrial-fanuc
fanuc_m430ia2p_moveit_config github-ros-industrial-fanuc
fanuc_m430ia_support github-ros-industrial-fanuc
fanuc_m6ib6s_moveit_config github-ros-industrial-fanuc
fanuc_m6ib_moveit_config github-ros-industrial-fanuc
fanuc_m6ib_support github-ros-industrial-fanuc
fanuc_m710ic_support github-ros-industrial-fanuc
fanuc_m900ia_support github-ros-industrial-fanuc
fanuc_m900ib_support github-ros-industrial-fanuc
fanuc_r1000ia80f_moveit_config github-ros-industrial-fanuc
fanuc_r1000ia_support github-ros-industrial-fanuc
fanuc_lrmate200id7l_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_support github-ros-industrial-fanuc_experimental
fanuc_r2000ib_support github-ros-industrial-fanuc_experimental
fanuc_r2000ic_support github-ros-industrial-fanuc_experimental
fetch_moveit_config github-fetchrobotics-fetch_ros
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
pr2eus github-jsk-ros-pkg-jsk_pr2eus
pr2eus_openrave github-jsk-ros-pkg-jsk_pr2eus
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
robot github-ros-metapackages
moveit_resources_dual_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_prbt_moveit_config github-ros-planning-moveit_resources
naoqi_driver github-ros-naoqi-naoqi_driver
pointgrey_camera_description github-ros-drivers-pointgrey_camera_driver
hrpsys_ros_bridge github-start-jsk-rtmros_common
sick_ldmrs_description github-SICKAG-sick_ldmrs_laser
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
uwsim github-uji-ros-pkg-underwater_simulation
urdf_tutorial github-ros-urdf_tutorial
rwt_moveit github-tork-a-visualization_rwt
ca_description github-AutonomyLab-create_autonomy
dynpick_driver github-tork-a-dynpick_driver
grizzly_description github-g-grizzly
hector_quadrotor_gazebo github-tu-darmstadt-ros-pkg-hector_quadrotor
katana_arm_gazebo github-uos-katana_driver
nao_moveit_config github-ros-naoqi-nao_moveit_config
nao_bringup github-ros-naoqi-nao_robot
nao_description github-ros-naoqi-nao_robot
nao_control github-ros-naoqi-nao_virtual
pepper_moveit_config github-ros-naoqi-pepper_moveit_config
pepper_description github-ros-naoqi-pepper_robot
pepper_control github-ros-naoqi-pepper_virtual
romeo_moveit_config github-ros-aldebaran-romeo_moveit_config
romeo_description github-ros-aldebaran-romeo_robot
romeo_control github-ros-aldebaran-romeo_virtual
rsv_balance_description github-robosavvy-rsv_balance
rsv_balance_gazebo github-robosavvy-rsv_balance_simulator
schunk_canopen_driver github-fzi-forschungszentrum-informatik-schunk_canopen_driver
aubo_gazebo github-auboliuxin-aubo_robot
aubo_i5_moveit_config github-auboliuxin-aubo_robot
tetris_gazebo github-tork-a-hakuto
rail_ceiling github-GT-RAIL-rail_ceiling
rail_collada_models github-GT-RAIL-rail_collada_models

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 1.11.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version indigo-devel
Last Updated 2019-02-08
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

Maintainers

  • Chris Lalancette
  • Shane Loretz

Authors

  • Ioan Sucan
  • Jackie Kay
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package robot_state_publisher

1.11.2 (2016-05-20)

  • Add back future dating for robot_state_publisher (#50)
  • Contributors: Jackie Kay

1.11.1 (2016-02-22)

  • Merge pull request #41 from ros/fix_tests_indigo Re-enable and clean up rostests
  • Correct failing tests
  • Re-enabling rostests
  • Fix API break in publishFixedTransforms A bool argument was added to RobotStatePublisher::publishFixedTransforms which broke API. I\'ve added a default value of false, to match the default specified in the JointStateListener constructor.
  • Contributors: Jackie Kay, Jonathan Bohren, Steven Peters

1.11.0 (2015-10-21)

  • Merge pull request #28 from clearpathrobotics/tf2-static Port to tf2 and enable using static broadcaster
  • Merge pull request #32 from shadow-robot/fix_issue#19 Check URDF to distinguish fixed joints from floating joints. Floating joint are ignored by the publisher.
  • Merge pull request #26 from xqms/remove-debug get rid of argv[0] debug output on startup
  • Contributors: David Lu!!, Ioan A Sucan, Jackie Kay, Max Schwarz, Paul Bovbel, Remo Diethelm, Toni Oliver

1.10.4 (2014-11-30)

  • Merge pull request #21 from rcodddow/patch-1
  • Fix for joint transforms not being published anymore after a clock reset (e.g. when playing a bagfile and looping)
  • Contributors: Ioan A Sucan, Robert Codd-Downey, Timm Linder

1.10.3 (2014-07-24)

  • add version depend on orocos_kdl >= 1.3.0 Conflicts: package.xml
  • Update KDL SegmentMap interface to optionally use shared pointers The KDL Tree API optionally uses shared pointers on platforms where the STL containers don\'t support incomplete types.
  • Contributors: Brian Jensen, William Woodall

1.10.0 (2014-03-03)

  • minor style fixes
  • Add support for mimic tag.
  • Contributors: Ioan Sucan, Konrad Banachowicz

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
abb_irb2400_moveit_config github-ros-industrial-abb
abb_irb2400_support github-ros-industrial-abb
abb_irb5400_support github-ros-industrial-abb
abb_irb6600_support github-ros-industrial-abb
abb_irb6640_moveit_config github-ros-industrial-abb
abb_irb6640_support github-ros-industrial-abb
ati_force_torque github-iirob-ati_force_torque
cartographer_ros github-googlecartographer-cartographer_ros
cob_cartesian_controller github-ipa320-cob_control
cob_obstacle_distance github-ipa320-cob_control
cob_twist_controller github-ipa320-cob_control
cob_grasp_generation github-ipa320-cob_manipulation
cob_moveit_bringup github-ipa320-cob_manipulation
cob_bringup github-ipa320-cob_robots
cob_hardware_config github-ipa320-cob_robots
cob_gazebo_worlds github-ipa320-cob_simulation
denso_robot_moveit_config github-DENSORobot-denso_robot_ros
fanuc_cr35ia_support github-ros-industrial-fanuc
fanuc_cr7ia_moveit_config github-ros-industrial-fanuc
fanuc_cr7ia_support github-ros-industrial-fanuc
fanuc_cr7ial_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200i_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200i_support github-ros-industrial-fanuc
fanuc_lrmate200ib3l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ib_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ib_support github-ros-industrial-fanuc
fanuc_lrmate200ic5h_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic5l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_support github-ros-industrial-fanuc
fanuc_m10ia_moveit_config github-ros-industrial-fanuc
fanuc_m10ia_support github-ros-industrial-fanuc
fanuc_m16ib20_moveit_config github-ros-industrial-fanuc
fanuc_m16ib_support github-ros-industrial-fanuc
fanuc_m20ia10l_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_support github-ros-industrial-fanuc
fanuc_m20ib25_moveit_config github-ros-industrial-fanuc
fanuc_m20ib_support github-ros-industrial-fanuc
fanuc_m430ia2f_moveit_config github-ros-industrial-fanuc
fanuc_m430ia2p_moveit_config github-ros-industrial-fanuc
fanuc_m430ia_support github-ros-industrial-fanuc
fanuc_m6ib6s_moveit_config github-ros-industrial-fanuc
fanuc_m6ib_moveit_config github-ros-industrial-fanuc
fanuc_m6ib_support github-ros-industrial-fanuc
fanuc_m710ic_support github-ros-industrial-fanuc
fanuc_m900ia_support github-ros-industrial-fanuc
fanuc_m900ib_support github-ros-industrial-fanuc
fanuc_r1000ia80f_moveit_config github-ros-industrial-fanuc
fanuc_r1000ia_support github-ros-industrial-fanuc
fanuc_lrmate200id7l_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_support github-ros-industrial-fanuc_experimental
fanuc_r2000ib_support github-ros-industrial-fanuc_experimental
fanuc_r2000ic_support github-ros-industrial-fanuc_experimental
fetchit_challenge github-fetchrobotics-fetch_gazebo
fetch_moveit_config github-fetchrobotics-fetch_ros
flir_ptu_driver github-ros-drivers-flir_ptu
flir_ptu_viz github-ros-drivers-flir_ptu
heron_description github-heron-heron
husky_description github-husky-husky
husky_ur5_moveit_config github-husky-husky
jackal_description github-jackal-jackal
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
pr2eus github-jsk-ros-pkg-jsk_pr2eus
pr2eus_openrave github-jsk-ros-pkg-jsk_pr2eus
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
kobuki_gazebo github-yujinrobot-kobuki_desktop
robot github-ros-metapackages
tra1_bringup github-tork-a-minas
tra1_description github-tork-a-minas
tra1_moveit_config github-tork-a-minas
mir_description github-dfki-ric-mir_robot
mir_driver github-dfki-ric-mir_robot
mir_gazebo github-dfki-ric-mir_robot
pr2_moveit_config github-ros-planning-moveit_pr2
moveit_resources_dual_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_prbt_moveit_config github-ros-planning-moveit_resources
mrp2_bringup github-milvusrobotics-mrp2_robot
naoqi_driver github-ros-naoqi-naoqi_driver
play_motion github-pal-robotics-play_motion
pointgrey_camera_description github-ros-drivers-pointgrey_camera_driver
pr2_bringup github-pr2-pr2_robot
raspimouse_control github-rt-net-raspimouse_sim
raspimouse_gazebo github-rt-net-raspimouse_sim
ridgeback_description github-ridgeback-ridgeback
hrpsys_ros_bridge github-start-jsk-rtmros_common
nextage_calibration github-tork-a-rtmros_nextage
nextage_moveit_config github-tork-a-rtmros_nextage
sick_ldmrs_description github-SICKAG-sick_ldmrs_laser
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_tim github-uos-sick_tim
sr_edc_controller_configuration github-shadow-robot-sr-ros-interface-ethercat
staubli_rx160_moveit_config github-ros-industrial-staubli
staubli_rx160_support github-ros-industrial-staubli
staubli_rx160_gazebo github-ros-industrial-staubli_experimental
staubli_tx60_gazebo github-ros-industrial-staubli_experimental
staubli_tx60_support github-ros-industrial-staubli_experimental
staubli_tx90_gazebo github-ros-industrial-staubli_experimental
staubli_tx90_support github-ros-industrial-staubli_experimental
uwsim github-uji-ros-pkg-underwater_simulation
ur10_moveit_config github-ros-industrial-universal_robot
ur3_moveit_config github-ros-industrial-universal_robot
ur5_moveit_config github-ros-industrial-universal_robot
ur_gazebo github-ros-industrial-universal_robot
urdf_tutorial github-ros-urdf_tutorial
rwt_moveit github-tork-a-visualization_rwt
warthog_description github-warthog-cpr-warthog
xpp_vis github-leggedrobotics-xpp
abb_irb120_gazebo github-ros-industrial-abb_experimental
abb_irb120_moveit_config github-ros-industrial-abb_experimental
abb_irb120_support github-ros-industrial-abb_experimental
abb_irb120t_moveit_config github-ros-industrial-abb_experimental
abb_irb4400_support github-ros-industrial-abb_experimental
ca_description github-AutonomyLab-create_autonomy
vs060_moveit_config github-start-jsk-denso
dynpick_driver github-tork-a-dynpick_driver
grizzly_description github-g-grizzly
grizzly_viz github-g-grizzly_desktop
hector_quadrotor_gazebo github-tu-darmstadt-ros-pkg-hector_quadrotor
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
rgbd_depth_correction github-ros-industrial-industrial_calibration
innok_heros_description github-innokrobotics-innok_heros_description
katana_arm_gazebo github-uos-katana_driver
kobuki_softnode github-yujinrobot-kobuki_soft
kuka_kr10_support github-ros-industrial-kuka_experimental
kuka_kr120_support github-ros-industrial-kuka_experimental
kuka_kr150_support github-ros-industrial-kuka_experimental
kuka_kr16_support github-ros-industrial-kuka_experimental
kuka_kr210_support github-ros-industrial-kuka_experimental
kuka_kr3_support github-ros-industrial-kuka_experimental
kuka_kr5_support github-ros-industrial-kuka_experimental
kuka_kr6_support github-ros-industrial-kuka_experimental
kuka_lbr_iiwa_support github-ros-industrial-kuka_experimental
motoman_mh5_support github-ros-industrial-motoman
motoman_sda10f_moveit_config github-ros-industrial-motoman
motoman_sda10f_support github-ros-industrial-motoman
motoman_sia10d_support github-ros-industrial-motoman
motoman_sia10f_support github-ros-industrial-motoman
motoman_sia20d_moveit_config github-ros-industrial-motoman
motoman_sia20d_support github-ros-industrial-motoman
motoman_sia5d_support github-ros-industrial-motoman
motoman_bmda3_support github-ros-industrial-motoman_experimental
motoman_mh_support github-ros-industrial-motoman_experimental
motoman_mpl80_moveit_config github-ros-industrial-motoman_experimental
motoman_mpl_support github-ros-industrial-motoman_experimental
motoman_sia5d_moveit_config github-ros-industrial-motoman_experimental
nao_moveit_config github-ros-naoqi-nao_moveit_config
nao_bringup github-ros-naoqi-nao_robot
nao_description github-ros-naoqi-nao_robot
nao_control github-ros-naoqi-nao_virtual
pepper_moveit_config github-ros-naoqi-pepper_moveit_config
pepper_description github-ros-naoqi-pepper_robot
pepper_control github-ros-naoqi-pepper_virtual
rb1_base_description github-RobotnikAutomation-rb1_base_common
rb1_base_kinova_j2n6a300_moveit_config github-RobotnikAutomation-rb1_base_common
rb1_base_control github-RobotnikAutomation-rb1_base_sim
rbcar_control github-RobotnikAutomation-rbcar_sim
roch_bringup github-SawYer-Robotics-roch
roch_description github-SawYer-Robotics-roch_robot
roch_gazebo github-SawYer-Robotics-roch_simulator
roch_viz github-SawYer-Robotics-roch_viz
romeo_moveit_config github-ros-aldebaran-romeo_moveit_config
romeo_description github-ros-aldebaran-romeo_robot
romeo_control github-ros-aldebaran-romeo_virtual
roomblock_bringup github-tork-a-roomblock
roomblock_description github-tork-a-roomblock
roomblock_mapping github-tork-a-roomblock
schunk_canopen_driver github-fzi-forschungszentrum-informatik-schunk_canopen_driver
summit_x_description github-RobotnikAutomation-summit_x_common
summit_x_control github-RobotnikAutomation-summit_x_sim
summit_xl_control github-RobotnikAutomation-summit_xl_common
summit_xl_description github-RobotnikAutomation-summit_xl_common
turtlebot_bringup github-turtlebot-turtlebot
turtlebot_arm_moveit_config github-turtlebot-turtlebot_arm
turtlebot_gazebo github-turtlebot-turtlebot_simulator
calvin_bringup github-uos-calvin_robot
calvin_gazebo github-uos-calvin_robot
calvin_moveit_config github-uos-calvin_robot
cyton_gamma_1500_description github-GertKanter-cyton_gamma_1500_description
husky_gazebo github-husky-husky_simulator
jsk_baxter_web github-jsk-ros-pkg-jsk_robot
jsk_cobotta_startup github-jsk-ros-pkg-jsk_robot
jsk_fetch_gazebo_demo github-jsk-ros-pkg-jsk_robot
jsk_kinova_startup github-jsk-ros-pkg-jsk_robot
kingfisher_description github-kf-kingfisher
kurt_bringup github-uos-kurt_driver
maxwell_defs github-mikeferguson-maxwell
maxwell_moveit_config github-mikeferguson-maxwell
hrp2w_moveit_config github-start-jsk-rtmros_gazebo
samplerobot_moveit_config github-start-jsk-rtmros_gazebo
staro_moveit_config github-start-jsk-rtmros_gazebo
segbot_bringup github-utexas-bwi-segbot
youbot_gazebo_robot github-youbot-youbot_simulation
aubo_gazebo github-auboliuxin-aubo_robot
aubo_i5_moveit_config github-auboliuxin-aubo_robot
carl_description github-GT-RAIL-carl_bot
carl_moveit github-GT-RAIL-carl_moveit
cirkit_unit03_description github-CIR-KIT-Unit03-cirkit_unit03_common
cirkit_unit03_bringup github-CIR-KIT-Unit03-cirkit_unit03_robot
cirkit_unit03_gazebo github-CIR-KIT-Unit03-cirkit_unit03_simulator
evarobot_state_publisher github-inomuh-evapc_ros
tetris_gazebo github-tork-a-hakuto
icart_mini_gazebo github-open-rdc-icart_mini
stomp_test_kr210_moveit_config github-ros-industrial-industrial_moveit
innok_heros_gazebo github-innokrobotics-innok_heros_gazebo
jaco_gazebo github-GT-RAIL-jaco_gazebo
jsk_arc2017_baxter github-start-jsk-jsk_apc
jsk_demo_common github-jsk-ros-pkg-jsk_demos
phantomx_reactor_arm_moveit_config github-RobotnikAutomation-phantomx_reactor_arm
rail_ceiling github-GT-RAIL-rail_ceiling
rail_collada_models github-GT-RAIL-rail_collada_models
rb1_jaco_3fg_moveit_config github-RobotnikAutomation-rb1_common
rb1_mico_3fg_moveit_config github-RobotnikAutomation-rb1_common
p3dx_urdf_model github-hrnr-robo-rescue
schunk_lwa4d github-ipa320-schunk_robots
schunk_lwa4d_moveit_config github-ipa320-schunk_robots
schunk_lwa4p github-ipa320-schunk_robots
schunk_lwa4p_extended github-ipa320-schunk_robots
schunk_pg70 github-ipa320-schunk_robots
schunk_pw70 github-ipa320-schunk_robots
spur_gazebo github-tork-a-spur
Multicar_moveit_config github-gus484-ros
widowx_arm_moveit github-RobotnikAutomation-widowx_arm
jaco_description github-RIVeR-Lab-wpi_jaco
jaco_moveit_config github-RIVeR-Lab-wpi_jaco
mico_description github-RIVeR-Lab-wpi_jaco
mico_moveit_config github-RIVeR-Lab-wpi_jaco
gazebo_mimic github-OrebroUniversity-yumi
yumi_control github-OrebroUniversity-yumi
yumi_moveit_config github-OrebroUniversity-yumi

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 1.9.12
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version hydro-devel
Last Updated 2014-11-30
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

Maintainers

  • Ioan Sucan

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package robot_state_publisher

1.9.12 (2014-11-30)

  • Backporting mimic support
  • Contributors: Ioan A Sucan, Konrad Banachowicz

1.9.11 (2014-07-24)

  • Update KDL SegmentMap interface to optionally use shared pointers The KDL Tree API optionally uses shared pointers on platforms where the STL containers don\'t support incomplete types.
  • Contributors: Brian Jensen, Ioan A Sucan

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
abb_irb2400_moveit_config github-ros-industrial-abb
abb_irb2400_support github-ros-industrial-abb
abb_irb5400_support github-ros-industrial-abb
abb_irb6600_support github-ros-industrial-abb
abb_irb6640_moveit_config github-ros-industrial-abb
irb_6640_moveit_config github-ros-industrial-abb
cob_bringup github-ipa320-cob_robots
cob_controller_configuration_gazebo github-ipa320-cob_robots
cob_gazebo github-ipa320-cob_simulation
fanuc_lrmate200ic5h_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic5l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_support github-ros-industrial-fanuc
fanuc_m10ia_moveit_config github-ros-industrial-fanuc
fanuc_m10ia_support github-ros-industrial-fanuc
fanuc_m16ib20_moveit_config github-ros-industrial-fanuc
fanuc_m16ib_support github-ros-industrial-fanuc
fanuc_m20ia10l_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_support github-ros-industrial-fanuc
fanuc_m430ia2f_moveit_config github-ros-industrial-fanuc
fanuc_m430ia2p_moveit_config github-ros-industrial-fanuc
fanuc_m430ia_support github-ros-industrial-fanuc
fanuc_lrmate200ib_support github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_support github-ros-industrial-fanuc_experimental
fanuc_m900ia_support github-ros-industrial-fanuc_experimental
flir_ptu_driver github-ros-drivers-flir_ptu
flir_ptu_viz github-ros-drivers-flir_ptu
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
pr2eus github-jsk-ros-pkg-jsk_pr2eus
pr2eus_openrave github-jsk-ros-pkg-jsk_pr2eus
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
kobuki_gazebo github-yujinrobot-kobuki_desktop
robot github-ros-metapackages
pr2_moveit_config github-ros-planning-moveit_pr2
moveit_resources_dual_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_prbt_moveit_config github-ros-planning-moveit_resources
play_motion github-pal-robotics-play_motion
pointgrey_camera_description github-ros-drivers-pointgrey_camera_driver
pr2_bringup github-PR2-pr2_robot
hrpsys_ros_bridge github-start-jsk-rtmros_common
staubli_rx160_moveit_config github-ros-industrial-staubli
staubli_rx160_support github-ros-industrial-staubli
ur10_moveit_config github-ros-industrial-universal_robot
ur5_moveit_config github-ros-industrial-universal_robot
ur_gazebo github-ros-industrial-universal_robot
urdf_tutorial github-ros-urdf_tutorial
rwt_moveit github-tork-a-visualization_rwt
vs060_moveit_config github-start-jsk-denso
dynpick_driver github-tork-a-dynpick_driver
grizzly_description github-g-grizzly
grizzly_viz github-g-grizzly_desktop
hector_quadrotor_gazebo github-tu-darmstadt-ros-pkg-hector_quadrotor
katana_arm_gazebo github-uos-katana_driver
kobuki_softnode github-yujinrobot-kobuki_soft
motoman_mh5_support github-ros-industrial-motoman
motoman_sia10d_support github-ros-industrial-motoman
motoman_sia20d_moveit_config github-ros-industrial-motoman
motoman_sia20d_support github-ros-industrial-motoman
motoman_sia5d_support github-ros-industrial-motoman
nao_moveit_config github-ros-naoqi-nao_moveit_config
nao_bringup github-ros-naoqi-nao_robot
nao_description github-ros-naoqi-nao_robot
nao_control github-ros-naoqi-nao_virtual
pepper_description github-ros-naoqi-pepper_robot
romeo_moveit_config github-ros-aldebaran-romeo_moveit_config
romeo_description github-ros-aldebaran-romeo_robot
turtlebot_bringup github-turtlebot-turtlebot
turtlebot_gazebo github-turtlebot-turtlebot_simulator
calvin_bringup github-uos-calvin_robot
calvin_gazebo github-uos-calvin_robot
calvin_moveit_config github-uos-calvin_robot
cob_3d_mapping_demonstrator github-ipa320-cob_environment_perception
crom_moveit_config github-RobotnikAutomation-crom_sim
cyton_gamma_1500_description github-GertKanter-cyton_gamma_1500_description
erratic_description github-arebgun-erratic_robot
hrl_kinematics github-ahornung-hrl_kinematics
husky_description github-husky-husky_description
husky_navigation github-husky-husky_navigation
joint_state_publisher_js github-DLu-joint_state_publisher_js
jsk_baxter_web github-jsk-ros-pkg-jsk_robot
jsk_cobotta_startup github-jsk-ros-pkg-jsk_robot
jsk_fetch_gazebo_demo github-jsk-ros-pkg-jsk_robot
jsk_kinova_startup github-jsk-ros-pkg-jsk_robot
kingfisher_description github-kf-kingfisher
kurt_bringup github-uos-kurt_driver
r2_fullbody_moveit_config github-DLu-nasa_r2_common
r2_moveit_config github-DLu-nasa_r2_common
r2_gazebo github-DLu-nasa_r2_simulator
pmb2_bringup github-pal-robotics-pmb2_robot
reemc_bringup github-pal-robotics-reemc_robot
roomba_robin_bringup github-robinJKU-roomba_robin
roomba_robin_gazebo github-robinJKU-roomba_robin_simulator
hrp2w_moveit_config github-start-jsk-rtmros_gazebo
samplerobot_moveit_config github-start-jsk-rtmros_gazebo
staro_moveit_config github-start-jsk-rtmros_gazebo
sr_hand github-shadow-robot-sr-ros-interface
sr_moveit_config github-shadow-robot-sr-ros-interface
wheeled_robin_bringup github-robinJKU-wheeled_robin
youbot_gazebo_robot github-youbot-youbot_simulation

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 1.13.7
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2019-08-27
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

Maintainers

  • Chris Lalancette
  • Ian McMahon
  • Shane Loretz

Authors

  • Ioan Sucan
  • Jackie Kay
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package robot_state_publisher

1.13.7 (2019-08-27)

  • Remove treefksolver completely from the repository. (#100) (#101)
  • Add Ian as a maintainer for robot_state_publisher (#95)
  • Fixed problem when building static library version (#92)
  • Contributors: Chris Lalancette, Shane Loretz, ivanpauno

1.13.6 (2018-04-05)

  • added warning when joint is found in joint message but not in the urdf (#83)
  • added ros_warn if JointStateMessage is older than 30 seconds (#84)
  • Add tcp_no_delay to joint_states subscriber (#80)
  • make rostest in CMakeLists optional (ros/rosdistro#3010) (#75)
  • Added c++11 target_compile_options (#78)
  • Contributors: Lukas Bulwahn, Shane Loretz, Victor Lopez, jgueldenstein

1.13.5 (2017-04-11)

  • Style cleanup throughout the tree.
  • add Chris and Shane as maintainers (#70)
  • Contributors: Chris Lalancette, William Woodall

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)
  • Error log for empty JointState.position was downgraded to a throttled warning (#64)
  • Contributors: Jochen Sprickerhof, S

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
abb_irb2400_moveit_config github-ros-industrial-abb
abb_irb2400_support github-ros-industrial-abb
abb_irb4400_support github-ros-industrial-abb
abb_irb5400_support github-ros-industrial-abb
abb_irb6600_support github-ros-industrial-abb
abb_irb6640_moveit_config github-ros-industrial-abb
abb_irb6640_support github-ros-industrial-abb
ati_force_torque github-KITrobotics-ati_force_torque
audibot_gazebo github-robustify-audibot
cartographer_ros github-googlecartographer-cartographer_ros
caster_control github-I-Quotient-Robotics-caster
cob_cartesian_controller github-ipa320-cob_control
cob_obstacle_distance github-ipa320-cob_control
cob_twist_controller github-ipa320-cob_control
cob_grasp_generation github-ipa320-cob_manipulation
cob_moveit_bringup github-ipa320-cob_manipulation
cob_bringup github-ipa320-cob_robots
cob_hardware_config github-ipa320-cob_robots
cob_gazebo_worlds github-ipa320-cob_simulation
crane_x7_moveit_config github-rt-net-crane_x7_ros
dbw_fca_description bitbucket-DataspeedInc-dbw_fca_ros
dbw_mkz_description bitbucket-dataspeedinc-dbw_mkz_ros
denso_robot_moveit_config github-DENSORobot-denso_robot_ros
desistek_saga_description github-uuvsimulator-desistek_saga
dynamic_robot_state_publisher github-peci1-dynamic_robot_state_publisher
eca_a9_description github-uuvsimulator-eca_a9
ensenso_camera github-ensenso-ros_driver
exotica_examples github-ipab-slmc-exotica
fake_joint_driver github-tork-a-fake_joint
fake_joint_launch github-tork-a-fake_joint
fanuc_cr35ia_support github-ros-industrial-fanuc
fanuc_cr7ia_moveit_config github-ros-industrial-fanuc
fanuc_cr7ia_support github-ros-industrial-fanuc
fanuc_cr7ial_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200i_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200i_support github-ros-industrial-fanuc
fanuc_lrmate200ib3l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ib_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ib_support github-ros-industrial-fanuc
fanuc_lrmate200ic5h_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic5l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_support github-ros-industrial-fanuc
fanuc_m10ia_moveit_config github-ros-industrial-fanuc
fanuc_m10ia_support github-ros-industrial-fanuc
fanuc_m16ib20_moveit_config github-ros-industrial-fanuc
fanuc_m16ib_support github-ros-industrial-fanuc
fanuc_m20ia10l_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_support github-ros-industrial-fanuc
fanuc_m20ib25_moveit_config github-ros-industrial-fanuc
fanuc_m20ib_support github-ros-industrial-fanuc
fanuc_m430ia2f_moveit_config github-ros-industrial-fanuc
fanuc_m430ia2p_moveit_config github-ros-industrial-fanuc
fanuc_m430ia_support github-ros-industrial-fanuc
fanuc_m6ib6s_moveit_config github-ros-industrial-fanuc
fanuc_m6ib_moveit_config github-ros-industrial-fanuc
fanuc_m6ib_support github-ros-industrial-fanuc
fanuc_m710ic_support github-ros-industrial-fanuc
fanuc_m900ia_support github-ros-industrial-fanuc
fanuc_m900ib_support github-ros-industrial-fanuc
fanuc_r1000ia80f_moveit_config github-ros-industrial-fanuc
fanuc_r1000ia_support github-ros-industrial-fanuc
fanuc_lrmate200id7l_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_support github-ros-industrial-fanuc_experimental
fanuc_r2000ib_support github-ros-industrial-fanuc_experimental
fanuc_r2000ic_support github-ros-industrial-fanuc_experimental
fetchit_challenge github-fetchrobotics-fetch_gazebo
fetch_moveit_config github-fetchrobotics-fetch_ros
flir_ptu_driver github-ros-drivers-flir_ptu
flir_ptu_viz github-ros-drivers-flir_ptu
franka_control github-frankaemika-franka_ros
fsrobo_r_bringup github-FUJISOFT-Robotics-fsrobo_r
fsrobo_r_description github-FUJISOFT-Robotics-fsrobo_r
fsrobo_r_moveit_config github-FUJISOFT-Robotics-fsrobo_r
gundam_rx78_control github-gundam-global-challenge-gundam_robot
gundam_rx78_description github-gundam-global-challenge-gundam_robot
heron_description github-heron-heron
heron_simulator github-heron-heron_simulator
husky_control github-husky-husky
husky_viz github-husky-husky
igvc_self_drive_gazebo github-robustify-igvc_self_drive_sim
igvc_self_drive_gazebo_plugins github-robustify-igvc_self_drive_sim
industrial_robot_client github-ros-industrial-industrial_core
jackal_description github-jackal-jackal
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
pr2eus github-jsk-ros-pkg-jsk_pr2eus
pr2eus_openrave github-jsk-ros-pkg-jsk_pr2eus
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
khi_duaro_moveit_config github-Kawasaki-Robotics-khi_robot
khi_robot_bringup github-Kawasaki-Robotics-khi_robot
khi_rs007l_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs007n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs013n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs020n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs025n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs030n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs080n_moveit_config github-Kawasaki-Robotics-khi_robot
kobuki_gazebo github-yujinrobot-kobuki_desktop
lauv_description github-uuvsimulator-lauv_gazebo
leo_description github-LeoRover-leo_common
leo_viz github-LeoRover-leo_desktop
leuze_bringup gitlab-cc-asp-fraunhofer-led-leuze_ros_drivers
leuze_description gitlab-cc-asp-fraunhofer-led-leuze_ros_drivers
robot github-ros-metapackages
tra1_bringup github-tork-a-minas
tra1_description github-tork-a-minas
tra1_moveit_config github-tork-a-minas
mir_description github-dfki-ric-mir_robot
mir_driver github-dfki-ric-mir_robot
mir_gazebo github-dfki-ric-mir_robot
moose_description github-moose-cpr-moose
moose_gazebo github-moose-cpr-moose_simulator
pr2_moveit_config github-ros-planning-moveit_pr2
moveit_resources_dual_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_prbt_moveit_config github-ros-planning-moveit_resources
multisense_bringup github-carnegierobotics-multisense_ros
naoqi_driver github-ros-naoqi-naoqi_driver
open_manipulator_description github-ROBOTIS-GIT-open_manipulator
open_manipulator_moveit github-ROBOTIS-GIT-open_manipulator
open_manipulator_p_description github-ROBOTIS-GIT-open_manipulator_p
open_manipulator_with_tb3_description github-ROBOTIS-GIT-open_manipulator_with_tb3
open_manipulator_with_tb3_tools github-ROBOTIS-GIT-open_manipulator_with_tb3
open_manipulator_with_tb3_waffle_moveit github-ROBOTIS-GIT-open_manipulator_with_tb3
open_manipulator_with_tb3_waffle_pi_moveit github-ROBOTIS-GIT-open_manipulator_with_tb3
panda_moveit_config github-ros-planning-panda_moveit_config
prbt_moveit_config github-PilzDE-pilz_robots
prbt_support github-PilzDE-pilz_robots
play_motion github-pal-robotics-play_motion
pointgrey_camera_description github-ros-drivers-pointgrey_camera_driver
pr2_bringup github-pr2-pr2_robot
pr2_gazebo github-PR2-pr2_simulator
raspimouse_description github-rt-net-raspimouse_description
rexrov2_description github-uuvsimulator-rexrov2
ridgeback_description github-ridgeback-ridgeback
hrpsys_ros_bridge github-start-jsk-rtmros_common
nextage_calibration github-tork-a-rtmros_nextage
nextage_moveit_config github-tork-a-rtmros_nextage
sciurus17_moveit_config github-rt-net-sciurus17_ros
seed_r7_bringup github-seed-solutions-seed_r7_ros_pkg
seed_r7_moveit_config github-seed-solutions-seed_r7_ros_pkg
seed_r7_typef_moveit_config github-seed-solutions-seed_r7_ros_pkg
seed_r7_typeg2_arm_moveit_config github-seed-solutions-seed_r7_ros_pkg
seed_r7_typeg_arm_moveit_config github-seed-solutions-seed_r7_ros_pkg
seed_r7_typeg_moveit_config github-seed-solutions-seed_r7_ros_pkg
sick_ldmrs_description github-SICKAG-sick_ldmrs_laser
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_tim github-uos-sick_tim
sr_hand github-shadow-robot-sr_core
sr_edc_controller_configuration github-shadow-robot-sr-ros-interface-ethercat
sr_moveit_hand_config github-shadow-robot-sr_interface
sr_box_ur10_moveit_config github-shadow-robot-sr_interface
sr_multi_moveit_config github-shadow-robot-sr_interface
sr_multi_moveit_test github-shadow-robot-sr_interface
sr_robot_launch github-shadow-robot-sr_interface
staubli_rx160_moveit_config github-ros-industrial-staubli
staubli_rx160_support github-ros-industrial-staubli
staubli_rx160_gazebo github-ros-industrial-staubli_experimental
staubli_tx2_60_support github-ros-industrial-staubli_experimental
staubli_tx2_90_support github-ros-industrial-staubli_experimental
staubli_tx60_gazebo github-ros-industrial-staubli_experimental
staubli_tx60_support github-ros-industrial-staubli_experimental
staubli_tx90_gazebo github-ros-industrial-staubli_experimental
staubli_tx90_support github-ros-industrial-staubli_experimental
talos_bringup github-pal-robotics-talos_robot
turtlebot3_bringup github-ROBOTIS-GIT-turtlebot3
turtlebot3_automatic_parking_vision github-ROBOTIS-GIT-turtlebot3_applications
turtlebot3_fake github-ROBOTIS-GIT-turtlebot3_simulations
uwsim github-uji-ros-pkg-underwater_simulation
ur10_e_moveit_config github-ros-industrial-universal_robot
ur10_moveit_config github-ros-industrial-universal_robot
ur3_e_moveit_config github-ros-industrial-universal_robot
ur3_moveit_config github-ros-industrial-universal_robot
ur5_e_moveit_config github-ros-industrial-universal_robot
ur5_moveit_config github-ros-industrial-universal_robot
ur_bringup github-ros-industrial-universal_robot
ur_description github-ros-industrial-universal_robot
ur_e_description github-ros-industrial-universal_robot
ur_e_gazebo github-ros-industrial-universal_robot
ur_gazebo github-ros-industrial-universal_robot
urdf_tutorial github-ros-urdf_tutorial
uuv_thruster_manager github-uuvsimulator-uuv_simulator
uuv_descriptions github-uuvsimulator-uuv_simulator
warthog_description github-warthog-cpr-warthog
webots_ros github-cyberbotics-webots_ros
xpp_vis github-leggedrobotics-xpp
abb_crb15000_support github-ros-industrial-abb_experimental
abb_irb1200_5_90_moveit_config github-ros-industrial-abb_experimental
abb_irb1200_7_70_moveit_config github-ros-industrial-abb_experimental
abb_irb1200_gazebo github-ros-industrial-abb_experimental
abb_irb1200_support github-ros-industrial-abb_experimental
abb_irb120_gazebo github-ros-industrial-abb_experimental
abb_irb120_moveit_config github-ros-industrial-abb_experimental
abb_irb120_support github-ros-industrial-abb_experimental
abb_irb120t_moveit_config github-ros-industrial-abb_experimental
abb_irb1600_6_12_moveit_config github-ros-industrial-abb_experimental
abb_irb1600_support github-ros-industrial-abb_experimental
abb_irb2600_support github-ros-industrial-abb_experimental
abb_irb4600_support github-ros-industrial-abb_experimental
abb_irb52_support github-ros-industrial-abb_experimental
abb_irb6650s_support github-ros-industrial-abb_experimental
abb_irb6700_support github-ros-industrial-abb_experimental
abb_irb7600_support github-ros-industrial-abb_experimental
framefab_irb6600_workspace_moveit_config github-yijiangh-Choreo
choreo_kr150_2_workspace_moveit_config github-yijiangh-Choreo
choreo_kr5_arc_workspace_moveit_config github-yijiangh-Choreo
kr6_r900_mit_suction_gripper_moveit_config github-yijiangh-Choreo
kr6_r900_workspace_moveit_config github-yijiangh-Choreo
ca_description github-AutonomyLab-create_autonomy
vs060_moveit_config github-start-jsk-denso
moveit_config_a0509 github-doosan-robotics-doosan-robot
moveit_config_a0912 github-doosan-robotics-doosan-robot
moveit_config_h2017 github-doosan-robotics-doosan-robot
moveit_config_h2515 github-doosan-robotics-doosan-robot
moveit_config_m0609 github-doosan-robotics-doosan-robot
moveit_config_m0617 github-doosan-robotics-doosan-robot
moveit_config_m1013 github-doosan-robotics-doosan-robot
moveit_config_m1509 github-doosan-robotics-doosan-robot
dynpick_driver github-tork-a-dynpick_driver
flir_camera_description github-ros-drivers-flir_camera_driver
grizzly_control github-g-grizzly
hector_quadrotor_gazebo github-tu-darmstadt-ros-pkg-hector_quadrotor
hsr_description github-ToyotaResearchInstitute-hsr_description
iiwa_moveit github-ipa-rwu-iiwa_stack
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
rgbd_depth_correction github-ros-industrial-industrial_calibration
innok_heros_description github-innokrobotics-innok_heros_description
katana_arm_gazebo github-uos-katana_driver
kobuki_softnode github-yujinrobot-kobuki_soft
kuka_kr10_support github-ros-industrial-kuka_experimental
kuka_kr120_support github-ros-industrial-kuka_experimental
kuka_kr150_support github-ros-industrial-kuka_experimental
kuka_kr16_support github-ros-industrial-kuka_experimental
kuka_kr210_support github-ros-industrial-kuka_experimental
kuka_kr3_support github-ros-industrial-kuka_experimental
kuka_kr5_support github-ros-industrial-kuka_experimental
kuka_kr6_support github-ros-industrial-kuka_experimental
kuka_lbr_iiwa_support github-ros-industrial-kuka_experimental
loki_description github-UbiquityRobotics-loki_robot
magni_bringup github-UbiquityRobotics-magni_robot
magni_description github-UbiquityRobotics-magni_robot
magni_gazebo github-UbiquityRobotics-magni_robot
manipulator_h_bringup github-ROBOTIS-GIT-ROBOTIS-MANIPULATOR-H
manipulator_h_description github-ROBOTIS-GIT-ROBOTIS-MANIPULATOR-H
melfa_description github-tork-a-melfa_robot
melfa_driver github-tork-a-melfa_robot
rv4fl_moveit_config github-tork-a-melfa_robot
rv7fl_moveit_config github-tork-a-melfa_robot
mobility_base_bringup bitbucket-dataspeedinc-mobility_base_ros
mobility_base_gazebo bitbucket-dataspeedinc-mobility_base_simulator
motoman_ar2010_support github-ros-industrial-motoman
motoman_es_support github-ros-industrial-motoman
motoman_gp110_support github-ros-industrial-motoman
motoman_gp12_support github-ros-industrial-motoman
motoman_gp180_support github-ros-industrial-motoman
motoman_gp200r_support github-ros-industrial-motoman
motoman_gp25_support github-ros-industrial-motoman
motoman_gp35l_support github-ros-industrial-motoman
motoman_gp4_support github-ros-industrial-motoman
motoman_gp50_support github-ros-industrial-motoman
motoman_gp70l_support github-ros-industrial-motoman
motoman_gp7_support github-ros-industrial-motoman
motoman_gp88_support github-ros-industrial-motoman
motoman_gp8_support github-ros-industrial-motoman
motoman_hc10_support github-ros-industrial-motoman
motoman_hc20_support github-ros-industrial-motoman
motoman_ma2010_moveit_config github-ros-industrial-motoman
motoman_ma2010_support github-ros-industrial-motoman
motoman_mh110_support github-ros-industrial-motoman
motoman_mh12_support github-ros-industrial-motoman
motoman_mh50_support github-ros-industrial-motoman
motoman_mh5_support github-ros-industrial-motoman
motoman_motomini_support github-ros-industrial-motoman
motoman_motopos_d500_support github-ros-industrial-motoman
motoman_ms210_moveit_config github-ros-industrial-motoman
motoman_ms210_support github-ros-industrial-motoman
motoman_sda10f_moveit_config github-ros-industrial-motoman
motoman_sda10f_support github-ros-industrial-motoman
motoman_sia10d_support github-ros-industrial-motoman
motoman_sia10f_support github-ros-industrial-motoman
motoman_sia20d_moveit_config github-ros-industrial-motoman
motoman_sia20d_support github-ros-industrial-motoman
motoman_sia30d_support github-ros-industrial-motoman
motoman_sia50_support github-ros-industrial-motoman
motoman_sia5d_support github-ros-industrial-motoman
motoman_bmda3_support github-ros-industrial-motoman_experimental
motoman_csda10f_moveit_config github-ros-industrial-motoman_experimental
motoman_csda10f_support github-ros-industrial-motoman_experimental
motoman_epx_support github-ros-industrial-motoman_experimental
motoman_mh_support github-ros-industrial-motoman_experimental
motoman_mhj_support github-ros-industrial-motoman_experimental
motoman_mpl80_moveit_config github-ros-industrial-motoman_experimental
motoman_mpl_support github-ros-industrial-motoman_experimental
motoman_mpx3500_support github-ros-industrial-motoman_experimental
motoman_sia5d_moveit_config github-ros-industrial-motoman_experimental
multi_jackal_base github-NicksSimulationsROS-multi_jackal
multi_jackal_description github-NicksSimulationsROS-multi_jackal
nao_moveit_config github-ros-naoqi-nao_moveit_config
nao_bringup github-ros-naoqi-nao_robot
nao_description github-ros-naoqi-nao_robot
nao_control github-ros-naoqi-nao_virtual
pepper_moveit_config github-ros-naoqi-pepper_moveit_config
pepper_description github-ros-naoqi-pepper_robot
pepper_control github-ros-naoqi-pepper_virtual
raspigibbon_control github-raspberrypigibbon-raspigibbon_sim
rb1_dual_ur3_moveit_config github-RobotnikAutomation-rb1_base_common
rbcar_control github-RobotnikAutomation-rbcar_sim
rh_p12_rn_description github-ROBOTIS-GIT-RH-P12-RN
op3_description github-ROBOTIS-GIT-ROBOTIS-OP3-Common
op3_bringup github-ROBOTIS-GIT-ROBOTIS-OP3-Demo
roch_description github-SawYer-Robotics-roch_robot
roch_gazebo github-SawYer-Robotics-roch_simulator
roch_viz github-SawYer-Robotics-roch_viz
romeo_moveit_config github-ros-aldebaran-romeo_moveit_config
romeo_description github-ros-aldebaran-romeo_robot
romeo_control github-ros-aldebaran-romeo_virtual
roomblock_bringup github-tork-a-roomblock
roomblock_description github-tork-a-roomblock
roomblock_mapping github-tork-a-roomblock
rsv_balance_description github-robosavvy-rsv_balance
rsv_balance_gazebo github-robosavvy-rsv_balance_simulator
schunk_canopen_driver github-fzi-forschungszentrum-informatik-schunk_canopen_driver
summit_x_description github-RobotnikAutomation-summit_x_common
summit_x_control github-RobotnikAutomation-summit_x_sim
summit_xl_j2n6s200_moveit_config github-RobotnikAutomation-summit_xl_common
summit_xl_j2s6s200_moveit_config github-RobotnikAutomation-summit_xl_common
summit_xl_j2s6s300_moveit_config github-RobotnikAutomation-summit_xl_common
summit_xl_j2s7s300_moveit_config github-RobotnikAutomation-summit_xl_common
summit_xl_description github-RobotnikAutomation-summit_xl_common
svenzva_moveit github-SvenzvaRobotics-svenzva_ros
thormang3_description github-ROBOTIS-GIT-ROBOTIS-THORMANG-Common
turtlebot_bringup github-turtlebot-turtlebot
turtlebot_arm_moveit_config github-turtlebot-turtlebot_arm
turtlebot_gazebo github-turtlebot-turtlebot_simulator
ur_modern_driver github-ros-industrial-ur_modern_driver
dual_xarm6_moveit_config github-xArm-Developer-xarm_ros
xarm5_vacuum_gripper_moveit_config github-xArm-Developer-xarm_ros
xarm6_vacuum_gripper_moveit_config github-xArm-Developer-xarm_ros
xarm7_vacuum_gripper_moveit_config github-xArm-Developer-xarm_ros
lite6_moveit_config github-xArm-Developer-xarm_ros
uf_robot_moveit_config github-xArm-Developer-xarm_ros
xarm5_gripper_moveit_config github-xArm-Developer-xarm_ros
xarm5_moveit_config github-xArm-Developer-xarm_ros
xarm6_gripper_moveit_config github-xArm-Developer-xarm_ros
xarm6_moveit_config github-xArm-Developer-xarm_ros
xarm7_gripper_moveit_config github-xArm-Developer-xarm_ros
xarm7_moveit_config github-xArm-Developer-xarm_ros
xarm_controller github-xArm-Developer-xarm_ros
xarm_gripper github-xArm-Developer-xarm_ros
xbot_description github-DroidAITech-xbot

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange

robot_state_publisher package from robot_state_publisher repo

robot_state_publisher

Package Summary

Tags No category tags.
Version 1.14.1
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/robot_state_publisher.git
VCS Type git
VCS Version melodic-devel
Last Updated 2020-10-05
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package allows you to publish the state of a robot to

Additional Links

Maintainers

  • Chris Lalancette
  • Ian McMahon
  • Shane Loretz

Authors

  • Ioan Sucan
  • Jackie Kay
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package robot_state_publisher

1.14.1 (2020-04-02)

  • Bump CMake version to avoid CMP0048 warning (#132)
  • Make sure to make sensor_msgs a catkin dependency. (#123)
  • Add joint_state_listener to the catkin package LIBRARIES (#112)
  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
abb_irb2400_moveit_config github-ros-industrial-abb
abb_irb2400_support github-ros-industrial-abb
abb_irb4400_support github-ros-industrial-abb
abb_irb5400_support github-ros-industrial-abb
abb_irb6600_support github-ros-industrial-abb
abb_irb6640_moveit_config github-ros-industrial-abb
abb_irb6640_support github-ros-industrial-abb
ati_force_torque github-KITrobotics-ati_force_torque
audibot_gazebo github-robustify-audibot
cartographer_ros github-googlecartographer-cartographer_ros
caster_control github-I-Quotient-Robotics-caster
cob_cartesian_controller github-ipa320-cob_control
cob_obstacle_distance github-ipa320-cob_control
cob_twist_controller github-ipa320-cob_control
cob_grasp_generation github-ipa320-cob_manipulation
cob_moveit_bringup github-ipa320-cob_manipulation
cob_bringup github-ipa320-cob_robots
cob_hardware_config github-ipa320-cob_robots
cob_gazebo_worlds github-ipa320-cob_simulation
crane_x7_moveit_config github-rt-net-crane_x7_ros
create_description github-AutonomyLab-create_robot
dbw_fca_description bitbucket-DataspeedInc-dbw_fca_ros
dbw_mkz_description bitbucket-dataspeedinc-dbw_mkz_ros
dbw_polaris_description bitbucket-DataspeedInc-dbw_polaris_ros
denso_robot_moveit_config github-DENSORobot-denso_robot_ros
desistek_saga_description github-uuvsimulator-desistek_saga
dingo_description github-dingo-cpr-dingo
dynamic_robot_state_publisher github-peci1-dynamic_robot_state_publisher
eca_a9_description github-uuvsimulator-eca_a9
ensenso_camera github-ensenso-ros_driver
exotica_examples github-ipab-slmc-exotica
fake_joint_driver github-tork-a-fake_joint
fake_joint_launch github-tork-a-fake_joint
fanuc_cr35ia_support github-ros-industrial-fanuc
fanuc_cr7ia_moveit_config github-ros-industrial-fanuc
fanuc_cr7ia_support github-ros-industrial-fanuc
fanuc_cr7ial_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200i_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200i_support github-ros-industrial-fanuc
fanuc_lrmate200ib3l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ib_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ib_support github-ros-industrial-fanuc
fanuc_lrmate200ic5h_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic5l_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_moveit_config github-ros-industrial-fanuc
fanuc_lrmate200ic_support github-ros-industrial-fanuc
fanuc_m10ia_moveit_config github-ros-industrial-fanuc
fanuc_m10ia_support github-ros-industrial-fanuc
fanuc_m16ib20_moveit_config github-ros-industrial-fanuc
fanuc_m16ib_support github-ros-industrial-fanuc
fanuc_m20ia10l_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_moveit_config github-ros-industrial-fanuc
fanuc_m20ia_support github-ros-industrial-fanuc
fanuc_m20ib25_moveit_config github-ros-industrial-fanuc
fanuc_m20ib_support github-ros-industrial-fanuc
fanuc_m430ia2f_moveit_config github-ros-industrial-fanuc
fanuc_m430ia2p_moveit_config github-ros-industrial-fanuc
fanuc_m430ia_support github-ros-industrial-fanuc
fanuc_m6ib6s_moveit_config github-ros-industrial-fanuc
fanuc_m6ib_moveit_config github-ros-industrial-fanuc
fanuc_m6ib_support github-ros-industrial-fanuc
fanuc_m710ic_support github-ros-industrial-fanuc
fanuc_m900ia_support github-ros-industrial-fanuc
fanuc_m900ib_support github-ros-industrial-fanuc
fanuc_r1000ia80f_moveit_config github-ros-industrial-fanuc
fanuc_r1000ia_support github-ros-industrial-fanuc
fanuc_lrmate200id7l_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_moveit_config github-ros-industrial-fanuc_experimental
fanuc_lrmate200id_support github-ros-industrial-fanuc_experimental
fanuc_r2000ib_support github-ros-industrial-fanuc_experimental
fanuc_r2000ic_support github-ros-industrial-fanuc_experimental
fetch_gazebo github-fetchrobotics-fetch_gazebo
fetchit_challenge github-fetchrobotics-fetch_gazebo
fetch_bringup github-fetchrobotics-fetch_robots
freight_bringup github-fetchrobotics-fetch_robots
fetch_moveit_config github-fetchrobotics-fetch_ros
flir_ptu_driver github-ros-drivers-flir_ptu
flir_ptu_viz github-ros-drivers-flir_ptu
franka_control github-frankaemika-franka_ros
fsrobo_r_bringup github-FUJISOFT-Robotics-fsrobo_r
fsrobo_r_description github-FUJISOFT-Robotics-fsrobo_r
fsrobo_r_moveit_config github-FUJISOFT-Robotics-fsrobo_r
gundam_rx78_control github-gundam-global-challenge-gundam_robot
gundam_rx78_description github-gundam-global-challenge-gundam_robot
heron_description github-heron-heron
heron_simulator github-heron-heron_simulator
husky_control github-husky-husky
husky_viz github-husky-husky
igvc_self_drive_gazebo github-robustify-igvc_self_drive_sim
igvc_self_drive_gazebo_plugins github-robustify-igvc_self_drive_sim
industrial_robot_client github-ros-industrial-industrial_core
jackal_description github-jackal-jackal
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
pr2eus github-jsk-ros-pkg-jsk_pr2eus
pr2eus_openrave github-jsk-ros-pkg-jsk_pr2eus
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
khi_duaro_moveit_config github-Kawasaki-Robotics-khi_robot
khi_robot_bringup github-Kawasaki-Robotics-khi_robot
khi_rs007l_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs007n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs013n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs020n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs025n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs030n_moveit_config github-Kawasaki-Robotics-khi_robot
khi_rs080n_moveit_config github-Kawasaki-Robotics-khi_robot
kobuki_gazebo github-yujinrobot-kobuki_desktop
lauv_description github-uuvsimulator-lauv_gazebo
leo_description github-LeoRover-leo_common
leo_viz github-LeoRover-leo_desktop
leo_bringup github-LeoRover-leo_robot
leuze_bringup gitlab-cc-asp-fraunhofer-led-leuze_ros_drivers
leuze_description gitlab-cc-asp-fraunhofer-led-leuze_ros_drivers
robot github-ros-metapackages
tra1_bringup github-tork-a-minas
tra1_description github-tork-a-minas
tra1_moveit_config github-tork-a-minas
mir_description github-DFKI-NI-mir_robot
mir_driver github-DFKI-NI-mir_robot
mir_gazebo github-DFKI-NI-mir_robot
moose_description github-moose-cpr-moose
moose_gazebo github-moose-cpr-moose_simulator
pr2_moveit_config github-ros-planning-moveit_pr2
moveit_resources_dual_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_fanuc_moveit_config github-ros-planning-moveit_resources
moveit_resources github-ros-planning-moveit_resources
moveit_resources_panda_moveit_config github-ros-planning-moveit_resources
moveit_resources_prbt_moveit_config github-ros-planning-moveit_resources
mrp2_teleop github-milvusrobotics-mrp2_common
mrp2_bringup github-milvusrobotics-mrp2_robot
multisense_bringup github-carnegierobotics-multisense_ros
naoqi_driver github-ros-naoqi-naoqi_driver
open_manipulator_description github-ROBOTIS-GIT-open_manipulator
open_manipulator_p_description github-ROBOTIS-GIT-open_manipulator_p
open_manipulator_with_tb3_description github-ROBOTIS-GIT-open_manipulator_with_tb3
open_manipulator_with_tb3_tools github-ROBOTIS-GIT-open_manipulator_with_tb3
open_manipulator_with_tb3_waffle_moveit github-ROBOTIS-GIT-open_manipulator_with_tb3
open_manipulator_with_tb3_waffle_pi_moveit github-ROBOTIS-GIT-open_manipulator_with_tb3
panda_moveit_config github-ros-planning-panda_moveit_config
pass_through_controllers github-UniversalRobots-Universal_Robots_ROS_passthrough_controllers
pf_description github-PepperlFuchs-pf_lidar_ros_driver
prbt_moveit_config github-PilzDE-pilz_robots
prbt_support github-PilzDE-pilz_robots
pincher_arm_bringup github-fictionlab-pincher_arm
pincher_arm_moveit_config github-fictionlab-pincher_arm
play_motion github-pal-robotics-play_motion
pointgrey_camera_description github-ros-drivers-pointgrey_camera_driver
pouco2000_ros_gazebo github-PoussPouss-pouco2000
pr2_controller_manager github-pr2-pr2_mechanism
pr2_bringup github-pr2-pr2_robot
pr2_gazebo github-PR2-pr2_simulator
psen_scan_v2 github-PilzDE-psen_scan_v2
raspimouse_description github-rt-net-raspimouse_description
rexrov2_description github-uuvsimulator-rexrov2
ridgeback_description github-ridgeback-ridgeback
robotont_description github-robotont-robotont_description
effort_controllers github-ros-controls-ros_controllers
cartesian_trajectory_controller github-UniversalRobots-Universal_Robots_ROS_controllers_cartesian
hrpsys_ros_bridge github-start-jsk-rtmros_common
nextage_calibration github-tork-a-rtmros_nextage
nextage_moveit_config github-tork-a-rtmros_nextage
schunk_svh_driver github-SCHUNK-GmbH-Co-KG-schunk_svh_ros_driver
sciurus17_moveit_config github-rt-net-sciurus17_ros
seed_r7_bringup github-seed-solutions-seed_r7_ros_pkg
seed_r7_moveit_config github-seed-solutions-seed_r7_ros_pkg
seed_r7_typef_moveit_config github-seed-solutions-seed_r7_ros_pkg
seed_r7_typeg2_arm_moveit_config github-seed-solutions-seed_r7_ros_pkg
seed_r7_typeg_arm_moveit_config github-seed-solutions-seed_r7_ros_pkg
seed_r7_typeg_moveit_config github-seed-solutions-seed_r7_ros_pkg
sick_ldmrs_description github-SICKAG-sick_ldmrs_laser
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
sick_tim github-uos-sick_tim
sr_hand github-shadow-robot-sr_core
sr_edc_controller_configuration github-shadow-robot-sr-ros-interface-ethercat
sr_moveit_hand_config github-shadow-robot-sr_interface
sr_box_ur10_moveit_config github-shadow-robot-sr_interface
sr_multi_moveit_config github-shadow-robot-sr_interface
sr_multi_moveit_test github-shadow-robot-sr_interface
sr_robot_launch github-shadow-robot-sr_interface
staubli_rx160_moveit_config github-ros-industrial-staubli
staubli_rx160_support github-ros-industrial-staubli
staubli_rx160_gazebo github-ros-industrial-staubli_experimental
staubli_tx2_60_support github-ros-industrial-staubli_experimental
staubli_tx2_90_support github-ros-industrial-staubli_experimental
staubli_tx60_gazebo github-ros-industrial-staubli_experimental
staubli_tx60_support github-ros-industrial-staubli_experimental
staubli_tx90_gazebo github-ros-industrial-staubli_experimental
staubli_tx90_support github-ros-industrial-staubli_experimental
talos_bringup github-pal-robotics-talos_robot
turtlebot3_bringup github-ROBOTIS-GIT-turtlebot3
turtlebot3_automatic_parking_vision github-ROBOTIS-GIT-turtlebot3_applications
turtlebot3_fake github-ROBOTIS-GIT-turtlebot3_simulations
uwsim github-uji-ros-pkg-underwater_simulation
ur10_moveit_config github-ros-industrial-universal_robot
ur10e_moveit_config github-ros-industrial-universal_robot
ur16e_moveit_config github-ros-industrial-universal_robot
ur3_moveit_config github-ros-industrial-universal_robot
ur3e_moveit_config github-ros-industrial-universal_robot
ur5_moveit_config github-ros-industrial-universal_robot
ur5e_moveit_config github-ros-industrial-universal_robot
ur_description github-ros-industrial-universal_robot
ur_gazebo github-ros-industrial-universal_robot
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS_Driver
urdf_sim_tutorial github-ros-urdf_sim_tutorial
urdf_tutorial github-ros-urdf_tutorial
uuv_thruster_manager github-uuvsimulator-uuv_simulator
uuv_descriptions github-uuvsimulator-uuv_simulator
rwt_moveit github-tork-a-visualization_rwt
warthog_description github-warthog-cpr-warthog
webots_ros github-cyberbotics-webots_ros
xpp_vis github-leggedrobotics-xpp

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged robot_state_publisher at Robotics Stack Exchange