Package symbol

moveit_visual_tools package from moveit_visual_tools repo

moveit_visual_tools

ROS Distro
humble

Package Summary

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

Repository Summary

Description Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Checkout URI https://github.com/ros-planning/moveit_visual_tools.git
VCS Type git
VCS Version ros2
Last Updated 2025-02-01
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

This open source project was developed at PickNik Robotics. Need professional ROS development and consulting? Contact us at projects@picknik.ai for a free consultation.

Status:

ROS:

  • Build and Test Formatting Github Actions
  • Build Status ROS Buildfarm - AMD64 Focal Source Build - Ubuntu 20.04 LTS
  • Build Status ROS Buildfarm - AMD64 Focal Devel Build - Ubuntu 20.04 LTS

ROS2:

  • Build and Test GHA: Build and Test
  • Formatting GHA: Formatting

ROS2 Install

Install From Source

Install moveit2 following the instructions here. After sourcing the moveit workspace clone this repository into a colcon workspace, import and install dependencies and build:

source ~/ws_moveit/install/setup.bash
cd $COLCON_WS/src
git clone -b ros2 https://github.com/ros-planning/moveit_visual_tools
vcs import < moveit_visual_tools/moveit_visual_tools.repos
rosdep install -r --from-paths . --ignore-src --rosdistro foxy -y
cd $COLCON_WS
colcon build --event-handlers desktop_notification- status- --cmake-args -DCMAKE_BUILD_TYPE=Release

Quick Start Demo

To run some demos displaying robot states and collision objects:

ros2 launch moveit_visual_tools demo_rviz.launch.py

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_ = std::make_shared<moveit_visual_tools::MoveItVisualTools>(node_, "world", "/moveit_visual_tools");

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

4.1.2 (2025-02-01)

4.1.1 (2024-11-29)

  • CI: Fix broken pre-commit action
  • CI: Return to custom cache action
  • Update status badges in README
  • Fix typo in warning message (#141)
  • CI: Fix ament_flake8 issues
  • CI: Update actions
  • Default state publisher topic to DISPLAY_ROBOT_STATE_TOPIC (#135)
  • Update GHA (#128)
  • publishTrajectoryLine(): issue error when no end-effector tips are found (#127)
  • Switch to clang-format-14 (#126)
  • Typo fix (#124)
  • Update README.md (#122)
  • Humble CI and clang-format updates (#120)
  • Contributors: Henning Kayser, Mario Prats, Paul Draghicescu, Robert Haschke, Stephanie Eng, Vatan Aksoy Tezer, mosfet80

4.1.0 (2022-05-09)

  • Update black version (#117)
  • Jammy fixes and clang-format-12 (#116)
  • Fixed deprecated call to PlanningSceneMonitor's constructor (#108)
  • Remove Foxy CI builds (#111)
  • Generate license using ament_copyright (#105)
  • Contributors: Jafar Abdi, Stephanie Eng, Vatan Aksoy Tezer

4.0.0 (2021-09-27)

  • Port to ros2 (#92)
  • Fix typo in package.xml (#87)
  • Contributors: Davide Faconti, Felix von Drigalski, Vatan Aksoy Tezer

3.6.0 (2020-10-09)

  • [feature] Unified collision environment used (#54)
  • [feature] publish cuboids with size (#59)
  • [feature] hideRobot(): use new .hide member of DisplayRobotState msg (#56)
  • [feature] Use first trajectory point as start state for visualization (#49)
  • [feature] exposing the publishers to the user (#48)
  • [feature] Highlight selected links in publishRobotState() + improved collision visualization (#45)
  • [fix] Update to Noetic and fix various warnings (#79)
  • [fix] Fix Eigen alignment (#63)
  • [fix] missing end effector markers because clear (#51)
  • [fix] Remove #attempts from setFromIK (#43)
  • [documentation] Update README.md (#69)
  • [documentation] update doc of hideRobot() (#64)
  • [maint] add soname version (#74)
  • [maint] Replace tf_conversions with tf2's toMsg / fromMsg (#66)
  • [maint] fix clang-tidy issue (#68)
  • [maint] Cleanup (#65)
    • Replace robot_model and robot_state namespaces by moveit::core
    • Fix clang-tidy issues
    • Remove deprecated function
  • [maint] Bump required cmake version (#62)

File truncated at 100 lines see the full file

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange

Package symbol

moveit_visual_tools package from moveit_visual_tools repo

moveit_visual_tools

ROS Distro
jazzy

Package Summary

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

Repository Summary

Description Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Checkout URI https://github.com/ros-planning/moveit_visual_tools.git
VCS Type git
VCS Version ros2
Last Updated 2025-02-01
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

This open source project was developed at PickNik Robotics. Need professional ROS development and consulting? Contact us at projects@picknik.ai for a free consultation.

Status:

ROS:

  • Build and Test Formatting Github Actions
  • Build Status ROS Buildfarm - AMD64 Focal Source Build - Ubuntu 20.04 LTS
  • Build Status ROS Buildfarm - AMD64 Focal Devel Build - Ubuntu 20.04 LTS

ROS2:

  • Build and Test GHA: Build and Test
  • Formatting GHA: Formatting

ROS2 Install

Install From Source

Install moveit2 following the instructions here. After sourcing the moveit workspace clone this repository into a colcon workspace, import and install dependencies and build:

source ~/ws_moveit/install/setup.bash
cd $COLCON_WS/src
git clone -b ros2 https://github.com/ros-planning/moveit_visual_tools
vcs import < moveit_visual_tools/moveit_visual_tools.repos
rosdep install -r --from-paths . --ignore-src --rosdistro foxy -y
cd $COLCON_WS
colcon build --event-handlers desktop_notification- status- --cmake-args -DCMAKE_BUILD_TYPE=Release

Quick Start Demo

To run some demos displaying robot states and collision objects:

ros2 launch moveit_visual_tools demo_rviz.launch.py

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_ = std::make_shared<moveit_visual_tools::MoveItVisualTools>(node_, "world", "/moveit_visual_tools");

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

4.1.2 (2025-02-01)

4.1.1 (2024-11-29)

  • CI: Fix broken pre-commit action
  • CI: Return to custom cache action
  • Update status badges in README
  • Fix typo in warning message (#141)
  • CI: Fix ament_flake8 issues
  • CI: Update actions
  • Default state publisher topic to DISPLAY_ROBOT_STATE_TOPIC (#135)
  • Update GHA (#128)
  • publishTrajectoryLine(): issue error when no end-effector tips are found (#127)
  • Switch to clang-format-14 (#126)
  • Typo fix (#124)
  • Update README.md (#122)
  • Humble CI and clang-format updates (#120)
  • Contributors: Henning Kayser, Mario Prats, Paul Draghicescu, Robert Haschke, Stephanie Eng, Vatan Aksoy Tezer, mosfet80

4.1.0 (2022-05-09)

  • Update black version (#117)
  • Jammy fixes and clang-format-12 (#116)
  • Fixed deprecated call to PlanningSceneMonitor's constructor (#108)
  • Remove Foxy CI builds (#111)
  • Generate license using ament_copyright (#105)
  • Contributors: Jafar Abdi, Stephanie Eng, Vatan Aksoy Tezer

4.0.0 (2021-09-27)

  • Port to ros2 (#92)
  • Fix typo in package.xml (#87)
  • Contributors: Davide Faconti, Felix von Drigalski, Vatan Aksoy Tezer

3.6.0 (2020-10-09)

  • [feature] Unified collision environment used (#54)
  • [feature] publish cuboids with size (#59)
  • [feature] hideRobot(): use new .hide member of DisplayRobotState msg (#56)
  • [feature] Use first trajectory point as start state for visualization (#49)
  • [feature] exposing the publishers to the user (#48)
  • [feature] Highlight selected links in publishRobotState() + improved collision visualization (#45)
  • [fix] Update to Noetic and fix various warnings (#79)
  • [fix] Fix Eigen alignment (#63)
  • [fix] missing end effector markers because clear (#51)
  • [fix] Remove #attempts from setFromIK (#43)
  • [documentation] Update README.md (#69)
  • [documentation] update doc of hideRobot() (#64)
  • [maint] add soname version (#74)
  • [maint] Replace tf_conversions with tf2's toMsg / fromMsg (#66)
  • [maint] fix clang-tidy issue (#68)
  • [maint] Cleanup (#65)
    • Replace robot_model and robot_state namespaces by moveit::core
    • Fix clang-tidy issues
    • Remove deprecated function
  • [maint] Bump required cmake version (#62)

File truncated at 100 lines see the full file

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange

Package symbol

moveit_visual_tools package from moveit_visual_tools repo

moveit_visual_tools

ROS Distro
kilted

Package Summary

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

Repository Summary

Description Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Checkout URI https://github.com/ros-planning/moveit_visual_tools.git
VCS Type git
VCS Version ros2
Last Updated 2025-02-01
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

This open source project was developed at PickNik Robotics. Need professional ROS development and consulting? Contact us at projects@picknik.ai for a free consultation.

Status:

ROS:

  • Build and Test Formatting Github Actions
  • Build Status ROS Buildfarm - AMD64 Focal Source Build - Ubuntu 20.04 LTS
  • Build Status ROS Buildfarm - AMD64 Focal Devel Build - Ubuntu 20.04 LTS

ROS2:

  • Build and Test GHA: Build and Test
  • Formatting GHA: Formatting

ROS2 Install

Install From Source

Install moveit2 following the instructions here. After sourcing the moveit workspace clone this repository into a colcon workspace, import and install dependencies and build:

source ~/ws_moveit/install/setup.bash
cd $COLCON_WS/src
git clone -b ros2 https://github.com/ros-planning/moveit_visual_tools
vcs import < moveit_visual_tools/moveit_visual_tools.repos
rosdep install -r --from-paths . --ignore-src --rosdistro foxy -y
cd $COLCON_WS
colcon build --event-handlers desktop_notification- status- --cmake-args -DCMAKE_BUILD_TYPE=Release

Quick Start Demo

To run some demos displaying robot states and collision objects:

ros2 launch moveit_visual_tools demo_rviz.launch.py

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_ = std::make_shared<moveit_visual_tools::MoveItVisualTools>(node_, "world", "/moveit_visual_tools");

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

4.1.2 (2025-02-01)

4.1.1 (2024-11-29)

  • CI: Fix broken pre-commit action
  • CI: Return to custom cache action
  • Update status badges in README
  • Fix typo in warning message (#141)
  • CI: Fix ament_flake8 issues
  • CI: Update actions
  • Default state publisher topic to DISPLAY_ROBOT_STATE_TOPIC (#135)
  • Update GHA (#128)
  • publishTrajectoryLine(): issue error when no end-effector tips are found (#127)
  • Switch to clang-format-14 (#126)
  • Typo fix (#124)
  • Update README.md (#122)
  • Humble CI and clang-format updates (#120)
  • Contributors: Henning Kayser, Mario Prats, Paul Draghicescu, Robert Haschke, Stephanie Eng, Vatan Aksoy Tezer, mosfet80

4.1.0 (2022-05-09)

  • Update black version (#117)
  • Jammy fixes and clang-format-12 (#116)
  • Fixed deprecated call to PlanningSceneMonitor's constructor (#108)
  • Remove Foxy CI builds (#111)
  • Generate license using ament_copyright (#105)
  • Contributors: Jafar Abdi, Stephanie Eng, Vatan Aksoy Tezer

4.0.0 (2021-09-27)

  • Port to ros2 (#92)
  • Fix typo in package.xml (#87)
  • Contributors: Davide Faconti, Felix von Drigalski, Vatan Aksoy Tezer

3.6.0 (2020-10-09)

  • [feature] Unified collision environment used (#54)
  • [feature] publish cuboids with size (#59)
  • [feature] hideRobot(): use new .hide member of DisplayRobotState msg (#56)
  • [feature] Use first trajectory point as start state for visualization (#49)
  • [feature] exposing the publishers to the user (#48)
  • [feature] Highlight selected links in publishRobotState() + improved collision visualization (#45)
  • [fix] Update to Noetic and fix various warnings (#79)
  • [fix] Fix Eigen alignment (#63)
  • [fix] missing end effector markers because clear (#51)
  • [fix] Remove #attempts from setFromIK (#43)
  • [documentation] Update README.md (#69)
  • [documentation] update doc of hideRobot() (#64)
  • [maint] add soname version (#74)
  • [maint] Replace tf_conversions with tf2's toMsg / fromMsg (#66)
  • [maint] fix clang-tidy issue (#68)
  • [maint] Cleanup (#65)
    • Replace robot_model and robot_state namespaces by moveit::core
    • Fix clang-tidy issues
    • Remove deprecated function
  • [maint] Bump required cmake version (#62)

File truncated at 100 lines see the full file

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange

Package symbol

moveit_visual_tools package from moveit_visual_tools repo

moveit_visual_tools

ROS Distro
rolling

Package Summary

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

Repository Summary

Description Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Checkout URI https://github.com/ros-planning/moveit_visual_tools.git
VCS Type git
VCS Version ros2
Last Updated 2025-02-01
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

This open source project was developed at PickNik Robotics. Need professional ROS development and consulting? Contact us at projects@picknik.ai for a free consultation.

Status:

ROS:

  • Build and Test Formatting Github Actions
  • Build Status ROS Buildfarm - AMD64 Focal Source Build - Ubuntu 20.04 LTS
  • Build Status ROS Buildfarm - AMD64 Focal Devel Build - Ubuntu 20.04 LTS

ROS2:

  • Build and Test GHA: Build and Test
  • Formatting GHA: Formatting

ROS2 Install

Install From Source

Install moveit2 following the instructions here. After sourcing the moveit workspace clone this repository into a colcon workspace, import and install dependencies and build:

source ~/ws_moveit/install/setup.bash
cd $COLCON_WS/src
git clone -b ros2 https://github.com/ros-planning/moveit_visual_tools
vcs import < moveit_visual_tools/moveit_visual_tools.repos
rosdep install -r --from-paths . --ignore-src --rosdistro foxy -y
cd $COLCON_WS
colcon build --event-handlers desktop_notification- status- --cmake-args -DCMAKE_BUILD_TYPE=Release

Quick Start Demo

To run some demos displaying robot states and collision objects:

ros2 launch moveit_visual_tools demo_rviz.launch.py

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_ = std::make_shared<moveit_visual_tools::MoveItVisualTools>(node_, "world", "/moveit_visual_tools");

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

4.1.2 (2025-02-01)

4.1.1 (2024-11-29)

  • CI: Fix broken pre-commit action
  • CI: Return to custom cache action
  • Update status badges in README
  • Fix typo in warning message (#141)
  • CI: Fix ament_flake8 issues
  • CI: Update actions
  • Default state publisher topic to DISPLAY_ROBOT_STATE_TOPIC (#135)
  • Update GHA (#128)
  • publishTrajectoryLine(): issue error when no end-effector tips are found (#127)
  • Switch to clang-format-14 (#126)
  • Typo fix (#124)
  • Update README.md (#122)
  • Humble CI and clang-format updates (#120)
  • Contributors: Henning Kayser, Mario Prats, Paul Draghicescu, Robert Haschke, Stephanie Eng, Vatan Aksoy Tezer, mosfet80

4.1.0 (2022-05-09)

  • Update black version (#117)
  • Jammy fixes and clang-format-12 (#116)
  • Fixed deprecated call to PlanningSceneMonitor's constructor (#108)
  • Remove Foxy CI builds (#111)
  • Generate license using ament_copyright (#105)
  • Contributors: Jafar Abdi, Stephanie Eng, Vatan Aksoy Tezer

4.0.0 (2021-09-27)

  • Port to ros2 (#92)
  • Fix typo in package.xml (#87)
  • Contributors: Davide Faconti, Felix von Drigalski, Vatan Aksoy Tezer

3.6.0 (2020-10-09)

  • [feature] Unified collision environment used (#54)
  • [feature] publish cuboids with size (#59)
  • [feature] hideRobot(): use new .hide member of DisplayRobotState msg (#56)
  • [feature] Use first trajectory point as start state for visualization (#49)
  • [feature] exposing the publishers to the user (#48)
  • [feature] Highlight selected links in publishRobotState() + improved collision visualization (#45)
  • [fix] Update to Noetic and fix various warnings (#79)
  • [fix] Fix Eigen alignment (#63)
  • [fix] missing end effector markers because clear (#51)
  • [fix] Remove #attempts from setFromIK (#43)
  • [documentation] Update README.md (#69)
  • [documentation] update doc of hideRobot() (#64)
  • [maint] add soname version (#74)
  • [maint] Replace tf_conversions with tf2's toMsg / fromMsg (#66)
  • [maint] fix clang-tidy issue (#68)
  • [maint] Cleanup (#65)
    • Replace robot_model and robot_state namespaces by moveit::core
    • Fix clang-tidy issues
    • Remove deprecated function
  • [maint] Bump required cmake version (#62)

File truncated at 100 lines see the full file

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange

Package symbol

moveit_visual_tools package from ros2-essentials repo

interbotix_footswitch_driver interbotix_footswitch_msgs interbotix_ros_slate interbotix_slate_driver interbotix_slate_msgs dynamixel_workbench_toolbox interbotix_ros_xseries interbotix_xs_driver interbotix_xs_msgs interbotix_xs_sdk interbotix_ros_xsarms_examples interbotix_xsarm_diagnostic_tool interbotix_xsarm_dual interbotix_xsarm_dual_joy interbotix_xsarm_joy interbotix_xsarm_moveit_interface interbotix_xsarm_pid interbotix_xsarm_puppet interbotix_ros_xsarms interbotix_xsarm_control interbotix_xsarm_descriptions interbotix_xsarm_moveit interbotix_xsarm_perception interbotix_xsarm_ros_control interbotix_xsarm_sim interbotix_common_modules interbotix_common_sim interbotix_common_toolbox interbotix_landmark_modules interbotix_moveit_interface interbotix_moveit_interface_msgs interbotix_tf_tools interbotix_io_modules interbotix_io_toolbox interbotix_perception_modules interbotix_perception_msgs interbotix_perception_pipelines interbotix_perception_toolbox interbotix_rpi_modules interbotix_rpi_msgs interbotix_rpi_toolbox interbotix_xs_modules interbotix_xs_ros_control interbotix_xs_rviz interbotix_xs_toolbox moveit_visual_tools cartographer_demo multi_lidar_desp multi_lidar_gazebo dg3f_m_driver dg3f_m_gz dg5f_driver dg5f_gz dg_description dg5f_isaacsim aws_robomaker_hospital_world aws_robomaker_small_house_world aws_robomaker_small_warehouse_world citysim clearpath_playpen gazebo_launch turtlebot3_gazebo champ champ_base champ_bringup champ_config champ_description champ_gazebo champ_msgs champ_navigation go2_bringup go2_description go2_navigation isaacsim lms1xx husky_base husky_bringup husky_control husky_description husky_desktop husky_gazebo husky_msgs husky_navigation husky_robot husky_simulator husky_viz cmd_vel_mux ecl_command_line ecl_concepts ecl_containers ecl_converters ecl_core ecl_core_apps ecl_devices ecl_eigen ecl_exceptions ecl_filesystem ecl_formatters ecl_geometry ecl_ipc ecl_linear_algebra ecl_manipulators ecl_math ecl_mobile_robot ecl_mpl ecl_sigslots ecl_statistics ecl_streams ecl_threads ecl_time ecl_type_traits ecl_utilities ecl_config ecl_console ecl_converters_lite ecl_errors ecl_io ecl_lite ecl_sigslots_lite ecl_time_lite kobuki_core kobuki_keyop kobuki_node kobuki_ros kobuki_ros_interfaces sophus kobuki_control kobuki_description kobuki_gazebo kobuki_launch kobuki_navigation kobuki_rviz velodyne_description velodyne_gazebo_plugins velodyne_simulator rtabmap_sim minimal_pkg turtlebot3 turtlebot3_bringup turtlebot3_cartographer turtlebot3_description turtlebot3_example turtlebot3_navigation2 turtlebot3_node turtlebot3_teleop turtlebot3_cartographer_ex turtlebot3_fake_node turtlebot3_simulations vlp_cartographer

ROS Distro
github

Package Summary

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

Repository Summary

Description A repo containing essential ROS2 Humble features for controlling Autonomous Mobile Robots (AMRs) and robotic arm manipulators.
Checkout URI https://github.com/j3soon/ros2-essentials.git
VCS Type git
VCS Version main
Last Updated 2025-07-28
Dev Status UNKNOWN
Released UNRELEASED
Tags docker robotics docker-compose ros isaac slam nvidia-docker ros2 isaacsim isaac-sim nav2 omniverse ros2-humble
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

This open source project was developed at PickNik Robotics. Need professional ROS development and consulting? Contact us at projects@picknik.ai for a free consultation.

Status:

ROS:

  • Build and Test Formatting Github Actions
  • Build Status ROS Buildfarm - AMD64 Focal Source Build - Ubuntu 20.04 LTS
  • Build Status ROS Buildfarm - AMD64 Focal Devel Build - Ubuntu 20.04 LTS

ROS2:

  • Build and Test GHA: Build and Test
  • Formatting GHA: Formatting

ROS2 Install

Install From Source

Install moveit2 following the instructions here. After sourcing the moveit workspace clone this repository into a colcon workspace, import and install dependencies and build:

source ~/ws_moveit/install/setup.bash
cd $COLCON_WS/src
git clone -b ros2 https://github.com/ros-planning/moveit_visual_tools
vcs import < moveit_visual_tools/moveit_visual_tools.repos
rosdep install -r --from-paths . --ignore-src --rosdistro foxy -y
cd $COLCON_WS
colcon build --event-handlers desktop_notification- status- --cmake-args -DCMAKE_BUILD_TYPE=Release

Quick Start Demo

To run some demos displaying robot states and collision objects:

ros2 launch moveit_visual_tools demo_rviz.launch.py

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_ = std::make_shared<moveit_visual_tools::MoveItVisualTools>(node_, "world", "/moveit_visual_tools");

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

4.1.0 (2022-05-09)

  • Update black version (#117)
  • Jammy fixes and clang-format-12 (#116)
  • Fixed deprecated call to PlanningSceneMonitor's constructor (#108)
  • Remove Foxy CI builds (#111)
  • Generate license using ament_copyright (#105)
  • Contributors: Jafar Abdi, Stephanie Eng, Vatan Aksoy Tezer

4.0.0 (2021-09-27)

  • Port to ros2 (#92)
  • Fix typo in package.xml (#87)
  • Contributors: Davide Faconti, Felix von Drigalski, Vatan Aksoy Tezer

3.6.0 (2020-10-09)

  • [feature] Unified collision environment used (#54)
  • [feature] publish cuboids with size (#59)
  • [feature] hideRobot(): use new .hide member of DisplayRobotState msg (#56)
  • [feature] Use first trajectory point as start state for visualization (#49)
  • [feature] exposing the publishers to the user (#48)
  • [feature] Highlight selected links in publishRobotState() + improved collision visualization (#45)
  • [fix] Update to Noetic and fix various warnings (#79)
  • [fix] Fix Eigen alignment (#63)
  • [fix] missing end effector markers because clear (#51)
  • [fix] Remove #attempts from setFromIK (#43)
  • [documentation] Update README.md (#69)
  • [documentation] update doc of hideRobot() (#64)
  • [maint] add soname version (#74)
  • [maint] Replace tf_conversions with tf2's toMsg / fromMsg (#66)
  • [maint] fix clang-tidy issue (#68)
  • [maint] Cleanup (#65)
    • Replace robot_model and robot_state namespaces by moveit::core
    • Fix clang-tidy issues
    • Remove deprecated function
  • [maint] Bump required cmake version (#62)
  • [maint] moveit.rosinstall: use master branch for all deps (#57)
  • [maint] drop melodic + kinetic support for master branch (#58)
  • [maint] Fix Travis config + issues (#47)
  • [maint] Change 'MoveIt!' to MoveIt
  • Contributors: Bjar Ne, Dave Coleman, Henning Kayser, Jafar Abdi, Jens P, Mark Moll, Michael Görner, Mike Lautman, Robert Haschke, Tyler Weaver

3.5.2 (2018-12-10)

  • Use LOGNAME for named logging (#42)
  • Eigen::Affine3d -> Eigen::Isometry3d (#39)
  • Contributors: Dave Coleman

3.5.1 (2018-11-14)

  • Adding trigger call to animations when batch_publishing_enabled_ is enabled (#36)
  • Contributors: Mike Lautman

3.5.0 (2018-09-05)

  • Add Markdown ROS Buildfarm badges for Melodic
  • Fixing melodic branch with tf2 updates (#34)
  • Additional visualization (#31)
    • adding a visualization for publishing a box with width, height,

File truncated at 100 lines see the full file

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange

Package symbol

moveit_visual_tools package from moveit_visual_tools repo

moveit_visual_tools

ROS Distro
galactic

Package Summary

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

Repository Summary

Description Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Checkout URI https://github.com/ros-planning/moveit_visual_tools.git
VCS Type git
VCS Version ros2
Last Updated 2025-02-01
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

This open source project was developed at PickNik Robotics. Need professional ROS development and consulting? Contact us at projects@picknik.ai for a free consultation.

Status:

ROS:

  • Build and Test Formatting Github Actions
  • Build Status ROS Buildfarm - AMD64 Focal Source Build - Ubuntu 20.04 LTS
  • Build Status ROS Buildfarm - AMD64 Focal Devel Build - Ubuntu 20.04 LTS

ROS2:

  • Build and Test GHA: Build and Test
  • Formatting GHA: Formatting

ROS2 Install

Install From Source

Install moveit2 following the instructions here. After sourcing the moveit workspace clone this repository into a colcon workspace, import and install dependencies and build:

source ~/ws_moveit/install/setup.bash
cd $COLCON_WS/src
git clone -b ros2 https://github.com/ros-planning/moveit_visual_tools
vcs import < moveit_visual_tools/moveit_visual_tools.repos
rosdep install -r --from-paths . --ignore-src --rosdistro foxy -y
cd $COLCON_WS
colcon build --event-handlers desktop_notification- status- --cmake-args -DCMAKE_BUILD_TYPE=Release

Quick Start Demo

To run some demos displaying robot states and collision objects:

ros2 launch moveit_visual_tools demo_rviz.launch.py

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_ = std::make_shared<moveit_visual_tools::MoveItVisualTools>(node_, "world", "/moveit_visual_tools");

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

4.1.2 (2025-02-01)

4.1.1 (2024-11-29)

  • CI: Fix broken pre-commit action
  • CI: Return to custom cache action
  • Update status badges in README
  • Fix typo in warning message (#141)
  • CI: Fix ament_flake8 issues
  • CI: Update actions
  • Default state publisher topic to DISPLAY_ROBOT_STATE_TOPIC (#135)
  • Update GHA (#128)
  • publishTrajectoryLine(): issue error when no end-effector tips are found (#127)
  • Switch to clang-format-14 (#126)
  • Typo fix (#124)
  • Update README.md (#122)
  • Humble CI and clang-format updates (#120)
  • Contributors: Henning Kayser, Mario Prats, Paul Draghicescu, Robert Haschke, Stephanie Eng, Vatan Aksoy Tezer, mosfet80

4.1.0 (2022-05-09)

  • Update black version (#117)
  • Jammy fixes and clang-format-12 (#116)
  • Fixed deprecated call to PlanningSceneMonitor's constructor (#108)
  • Remove Foxy CI builds (#111)
  • Generate license using ament_copyright (#105)
  • Contributors: Jafar Abdi, Stephanie Eng, Vatan Aksoy Tezer

4.0.0 (2021-09-27)

  • Port to ros2 (#92)
  • Fix typo in package.xml (#87)
  • Contributors: Davide Faconti, Felix von Drigalski, Vatan Aksoy Tezer

3.6.0 (2020-10-09)

  • [feature] Unified collision environment used (#54)
  • [feature] publish cuboids with size (#59)
  • [feature] hideRobot(): use new .hide member of DisplayRobotState msg (#56)
  • [feature] Use first trajectory point as start state for visualization (#49)
  • [feature] exposing the publishers to the user (#48)
  • [feature] Highlight selected links in publishRobotState() + improved collision visualization (#45)
  • [fix] Update to Noetic and fix various warnings (#79)
  • [fix] Fix Eigen alignment (#63)
  • [fix] missing end effector markers because clear (#51)
  • [fix] Remove #attempts from setFromIK (#43)
  • [documentation] Update README.md (#69)
  • [documentation] update doc of hideRobot() (#64)
  • [maint] add soname version (#74)
  • [maint] Replace tf_conversions with tf2's toMsg / fromMsg (#66)
  • [maint] fix clang-tidy issue (#68)
  • [maint] Cleanup (#65)
    • Replace robot_model and robot_state namespaces by moveit::core
    • Fix clang-tidy issues
    • Remove deprecated function
  • [maint] Bump required cmake version (#62)

File truncated at 100 lines see the full file

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange

Package symbol

moveit_visual_tools package from moveit_visual_tools repo

moveit_visual_tools

ROS Distro
iron

Package Summary

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

Repository Summary

Description Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Checkout URI https://github.com/ros-planning/moveit_visual_tools.git
VCS Type git
VCS Version ros2
Last Updated 2025-02-01
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

This open source project was developed at PickNik Robotics. Need professional ROS development and consulting? Contact us at projects@picknik.ai for a free consultation.

Status:

ROS:

  • Build and Test Formatting Github Actions
  • Build Status ROS Buildfarm - AMD64 Focal Source Build - Ubuntu 20.04 LTS
  • Build Status ROS Buildfarm - AMD64 Focal Devel Build - Ubuntu 20.04 LTS

ROS2:

  • Build and Test GHA: Build and Test
  • Formatting GHA: Formatting

ROS2 Install

Install From Source

Install moveit2 following the instructions here. After sourcing the moveit workspace clone this repository into a colcon workspace, import and install dependencies and build:

source ~/ws_moveit/install/setup.bash
cd $COLCON_WS/src
git clone -b ros2 https://github.com/ros-planning/moveit_visual_tools
vcs import < moveit_visual_tools/moveit_visual_tools.repos
rosdep install -r --from-paths . --ignore-src --rosdistro foxy -y
cd $COLCON_WS
colcon build --event-handlers desktop_notification- status- --cmake-args -DCMAKE_BUILD_TYPE=Release

Quick Start Demo

To run some demos displaying robot states and collision objects:

ros2 launch moveit_visual_tools demo_rviz.launch.py

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_ = std::make_shared<moveit_visual_tools::MoveItVisualTools>(node_, "world", "/moveit_visual_tools");

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

4.1.2 (2025-02-01)

4.1.1 (2024-11-29)

  • CI: Fix broken pre-commit action
  • CI: Return to custom cache action
  • Update status badges in README
  • Fix typo in warning message (#141)
  • CI: Fix ament_flake8 issues
  • CI: Update actions
  • Default state publisher topic to DISPLAY_ROBOT_STATE_TOPIC (#135)
  • Update GHA (#128)
  • publishTrajectoryLine(): issue error when no end-effector tips are found (#127)
  • Switch to clang-format-14 (#126)
  • Typo fix (#124)
  • Update README.md (#122)
  • Humble CI and clang-format updates (#120)
  • Contributors: Henning Kayser, Mario Prats, Paul Draghicescu, Robert Haschke, Stephanie Eng, Vatan Aksoy Tezer, mosfet80

4.1.0 (2022-05-09)

  • Update black version (#117)
  • Jammy fixes and clang-format-12 (#116)
  • Fixed deprecated call to PlanningSceneMonitor's constructor (#108)
  • Remove Foxy CI builds (#111)
  • Generate license using ament_copyright (#105)
  • Contributors: Jafar Abdi, Stephanie Eng, Vatan Aksoy Tezer

4.0.0 (2021-09-27)

  • Port to ros2 (#92)
  • Fix typo in package.xml (#87)
  • Contributors: Davide Faconti, Felix von Drigalski, Vatan Aksoy Tezer

3.6.0 (2020-10-09)

  • [feature] Unified collision environment used (#54)
  • [feature] publish cuboids with size (#59)
  • [feature] hideRobot(): use new .hide member of DisplayRobotState msg (#56)
  • [feature] Use first trajectory point as start state for visualization (#49)
  • [feature] exposing the publishers to the user (#48)
  • [feature] Highlight selected links in publishRobotState() + improved collision visualization (#45)
  • [fix] Update to Noetic and fix various warnings (#79)
  • [fix] Fix Eigen alignment (#63)
  • [fix] missing end effector markers because clear (#51)
  • [fix] Remove #attempts from setFromIK (#43)
  • [documentation] Update README.md (#69)
  • [documentation] update doc of hideRobot() (#64)
  • [maint] add soname version (#74)
  • [maint] Replace tf_conversions with tf2's toMsg / fromMsg (#66)
  • [maint] fix clang-tidy issue (#68)
  • [maint] Cleanup (#65)
    • Replace robot_model and robot_state namespaces by moveit::core
    • Fix clang-tidy issues
    • Remove deprecated function
  • [maint] Bump required cmake version (#62)

File truncated at 100 lines see the full file

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange

Package symbol

moveit_visual_tools package from moveit_visual_tools repo

moveit_visual_tools

ROS Distro
melodic

Package Summary

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

Repository Summary

Description Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Checkout URI https://github.com/ros-planning/moveit_visual_tools.git
VCS Type git
VCS Version melodic-devel
Last Updated 2020-08-03
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

Developed by Dave Coleman at the Correll Robotics Lab, University of Colorado Boulder with outside contributors.

  • Build Status Travis CI
  • Build Status ROS Buildfarm - AMD64 Xenial Debian Build - Ubuntu 16.04 LTS
  • Build Status ROS Buildfarm - AMD64 Xenial Devel Build - Ubuntu 16.04 LTS
  • Build Status ROS Buildfarm - AMD64 Bionic Source Build - Ubuntu 18.04 LTS
  • Build Status ROS Buildfarm - AMD64 Bionic Devel Build - Ubuntu 18.04 LTS

Install

Ubuntu Debian

sudo apt-get install ros-kinetic-moveit-visual-tools

Install From Source

Clone this repository into a catkin workspace, then use the rosdep install tool to automatically download its dependencies. Depending on your current version of ROS, use:

rosdep install --from-paths src --ignore-src --rosdistro kinetic

Quick Start Demo

First launch Rviz:

roslaunch moveit_visual_tools demo_rviz.launch

Then run some demos displaying robot states and collision objects:

roslaunch moveit_visual_tools demo.launch

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_.reset(new moveit_visual_tools::MoveItVisualTools("base_frame","/moveit_visual_markers"));

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint
  • publishRobotState
  • publishAnimatedGrasps
  • publishIKSolutions

Show parts of a robot

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

3.5.2 (2018-12-10)

  • Use LOGNAME for named logging (#42)
  • Eigen::Affine3d -> Eigen::Isometry3d (#39)
  • Contributors: Dave Coleman

3.5.1 (2018-11-14)

  • Adding trigger call to animations when batch_publishing_enabled_ is enabled (#36)
  • Contributors: Mike Lautman

3.5.0 (2018-09-05)

  • Add Markdown ROS Buildfarm badges for Melodic
  • Fixing melodic branch with tf2 updates (#34)
  • Additional visualization (#31)
    • adding a visualization for publishing a box with width, height, and depth
    • adding additional publishCollisionCuboid method overloads
    • changing x,y,z to width, depth, height
  • Fixup CMakeLists and package.xml (#30)
  • Triggering UPDATE_GEOMETRY is sufficient, dont spinOnce
    • triggering UPDATE_SCENE leads to sending a full planning scene including all meshes. For all use-cases in this lib UPDATE_GEOMETRY is sufficient and sends only diffs
    • calling ros::spinOnce() in random places messes up the event queue (e.g. joint state updates being processed in gui thread instead of the async spinner thread)
  • Fix API compatibility by providing a default empty list of end-effector joints
  • Allow setting joint values for end-effector marker currently end-effector markers are based on the default robot state (ie all zero), this allows passing a vector of doubles for all active joint in the end-effector group Passing a new set of joint values will invalidate the cache but for our use-case this is neglectible and could be optimized later
  • Moved boost::shared_ptr to std for tf2
  • Converted to use tf2 moveit interfaces
  • Fix broken CI for Melodic
  • Fix Continuous Integration
  • Contributors: Dave Coleman, Ian McMahon, Mike Lautman, Simon Schmeisser

3.4.0 (2017-12-27)

  • Apply current MoveIt clang-format
  • Various improvements needed while finishing planning thesis
  • Fix greater than/less than issue in clearance check
  • Ability to specify clearance for random state
  • Small threading fixes
  • imarker: Fix setToRandomState() imarker: Switch to std::makeshared
  • Improve console output
  • Contributors: Dave Coleman, Mike Lautman

3.3.0 (2017-06-20)

  • Change error message to warning
  • Make planning scene monitor publicly exposed
  • Remove label from imarkers
  • Ability to move a collision object without removing it first
  • IMarkerRobotState: update imarkers location when setting robot state
  • IMarkerRobotState: Added setRobotState()
  • IMarkerRobotState: Renamed function publishRobotState()
  • MoveItVisualTools: renamed variable to psm_
  • Expose verbose collision checking
  • Contributors: Dave Coleman

3.2.1 (2016-11-02)

  • New publishTrajectoryPath() functions
  • New publishTrajectoryLine() functions
  • getRobotState() return by reference
  • Trajectory path has smaller vertices
  • IMarkerRobotState: added isStateValid()
  • Contributors: Dave Coleman

3.2.0 (2016-10-20)

  • Added publishState() to imarker_robot_state
  • New publishTrajectoryLine() function that automatically chooses end effectors to visualize
  • New collision table function that takes z input
  • Fixed callbacks for multiple EEFs
  • Allow for two end effectors
  • Ability to use two end effectors for interactive markers
  • Make ik solving at any end effector link, not just end of kinematic chain
  • Better debugging for collision
  • Only save when mouse up
  • Fix API for changes in rviz_visual_tools
  • Allow collision walls to have variable z location

File truncated at 100 lines see the full file

Launch files

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange

Package symbol

moveit_visual_tools package from moveit_visual_tools repo

moveit_visual_tools

ROS Distro
noetic

Package Summary

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

Repository Summary

Description Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
Checkout URI https://github.com/ros-planning/moveit_visual_tools.git
VCS Type git
VCS Version noetic-devel
Last Updated 2024-10-14
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

Helper functions for displaying and debugging MoveIt data in Rviz via published markers

Additional Links

Maintainers

  • Dave Coleman

Authors

  • Dave Coleman

MoveIt Visual Tools

Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of rviz_visual_tools and all those features are included via class inheritance.

This package helps you visualize:

  • Basic Rviz geometric shapes
  • MoveIt collision objects
  • MoveIt and ROS trajectories
  • Robot states
  • End effectors
  • Interactive markers to move robot arms using IK from remote applications

This open source project was developed at PickNik Robotics. Need professional ROS development and consulting? Contact us at projects@picknik.ai for a free consultation.

Status:

ROS:

  • Build and Test Formatting Github Actions
  • Build Status ROS Buildfarm - AMD64 Focal Source Build - Ubuntu 20.04 LTS
  • Build Status ROS Buildfarm - AMD64 Focal Devel Build - Ubuntu 20.04 LTS

Install

Ubuntu Debian

sudo apt-get install ros-kinetic-moveit-visual-tools

Install From Source

Clone this repository into a catkin workspace, then use the rosdep install tool to automatically download its dependencies. Depending on your current version of ROS, use:

rosdep install --from-paths src --ignore-src --rosdistro kinetic

Quick Start Demo

First launch Rviz:

roslaunch moveit_visual_tools demo_rviz.launch

Then run some demos displaying robot states and collision objects:

roslaunch moveit_visual_tools demo.launch

Code API

See VisualTools Class Reference

Usage

We’ll assume you will be using these helper functions within a class.

Initialize

Add to your includes:

#include <moveit_visual_tools/moveit_visual_tools.h>

Add to your class’s member variables:

// For visualizing things in rviz
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_;

In your class’ constructor add:

visual_tools_.reset(new moveit_visual_tools::MoveItVisualTools("base_frame","/moveit_visual_markers"));

Collision Object Functions

Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.

  • cleanupCO
  • cleanupACO
  • attachCO
  • publishCollisionBlock
  • publishCollisionCylinder
  • publishCollisionTree
  • publishCollisionTable
  • publishCollisionWall

And more…

Animate Trajectories

Higher level robot and trajectory functions

  • publishTrajectoryPath
  • publishTrajectoryPoint
  • publishRobotState
  • publishAnimatedGrasps
  • publishIKSolutions

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package moveit_visual_tools

3.6.1 (2023-05-18)

  • publishTrajectoryLine(): issue error when no end-effector tips are found (#129)
  • Fixed possible null-pointer segfault (#95)
  • Only set active joints (#84)
  • Use specified color for EndEffector marker (#96)
  • Contributors: Felix von Drigalski, Henning Kayser, Jochen Sprickerhof, Michael Görner, Robert Haschke, Simon Schmeisser, Stephanie Eng, Tyler Weaver, Vatan Aksoy Tezer, werner291

3.6.0 (2020-10-09)

  • [feature] Unified collision environment used (#54)
  • [feature] publish cuboids with size (#59)
  • [feature] hideRobot(): use new .hide member of DisplayRobotState msg (#56)
  • [feature] Use first trajectory point as start state for visualization (#49)
  • [feature] exposing the publishers to the user (#48)
  • [feature] Highlight selected links in publishRobotState() + improved collision visualization (#45)
  • [fix] Update to Noetic and fix various warnings (#79)
  • [fix] Fix Eigen alignment (#63)
  • [fix] missing end effector markers because clear (#51)
  • [fix] Remove #attempts from setFromIK (#43)
  • [documentation] Update README.md (#69)
  • [documentation] update doc of hideRobot() (#64)
  • [maint] add soname version (#74)
  • [maint] Replace tf_conversions with tf2's toMsg / fromMsg (#66)
  • [maint] fix clang-tidy issue (#68)
  • [maint] Cleanup (#65)
    • Replace robot_model and robot_state namespaces by moveit::core
    • Fix clang-tidy issues
    • Remove deprecated function
  • [maint] Bump required cmake version (#62)
  • [maint] moveit.rosinstall: use master branch for all deps (#57)
  • [maint] drop melodic + kinetic support for master branch (#58)
  • [maint] Fix Travis config + issues (#47)
  • [maint] Change 'MoveIt!' to MoveIt
  • Contributors: Bjar Ne, Dave Coleman, Henning Kayser, Jafar Abdi, Jens P, Mark Moll, Michael Görner, Mike Lautman, Robert Haschke, Tyler Weaver

3.5.2 (2018-12-10)

  • Use LOGNAME for named logging (#42)
  • Eigen::Affine3d -> Eigen::Isometry3d (#39)
  • Contributors: Dave Coleman

3.5.1 (2018-11-14)

  • Adding trigger call to animations when batch_publishing_enabled_ is enabled (#36)
  • Contributors: Mike Lautman

3.5.0 (2018-09-05)

  • Add Markdown ROS Buildfarm badges for Melodic
  • Fixing melodic branch with tf2 updates (#34)
  • Additional visualization (#31)
    • adding a visualization for publishing a box with width, height, and depth
    • adding additional publishCollisionCuboid method overloads
    • changing x,y,z to width, depth, height
  • Fixup CMakeLists and package.xml (#30)
  • Triggering UPDATE_GEOMETRY is sufficient, dont spinOnce
    • triggering UPDATE_SCENE leads to sending a full planning scene

File truncated at 100 lines see the full file

Launch files

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged moveit_visual_tools at Robotics Stack Exchange