ros / common_msgs

Commonly used messages in ROS. Includes messages for actions (actionlib_msgs), diagnostics (diagnostic_msgs), geometric primitives (geometry_msgs), robot navigation (nav_msgs), and common sensors (sensor_msgs), such as laser range finders, cameras, point clouds.
http://wiki.ros.org/common_msgs
177 stars 191 forks source link

Adds ARROW_STRIP Marker type #190

Closed rr-tom-noble closed 1 year ago

rr-tom-noble commented 1 year ago

Adds a new ARROW_STRIP Marker type for rendering batches of arrows.

Rviz Issue: https://github.com/ros-visualization/rviz/issues/1785 Rviz PR: https://github.com/ros-visualization/rviz/pull/1786

rr-tom-noble commented 1 year ago

Hey @tfoote, could I get you to take a look at this? The corresponding Rviz PR is ready for review

rr-tom-noble commented 1 year ago

Overall this seems like a good addition. My first reaction is to suggest that it be targeted for https://github.com/ros2/common_interfaces not here. This is a bit of a feature enhancement going into a stable release. But this is small enough that I would consider making it an exception.

However I would like to see it reviewed and merged to the new development version: https://github.com/ros2/common_interfaces and then once that's reviewed backported here. That way anyone who starts using it here won't get caught flat footed when they want to move forward.

That makes sense. The reason for targeting ROS1 was simply that it's the platform we're currently using, though we're planning to migrate to ROS2 next month. I'd be happy to raise the PR in https://github.com/ros2/common_interfaces, although due to software restrictions on my work machine, I likely won't be able to work on a ROS2 version of the corresponding Rviz PR until we start the migration in April.

I'll raise that PR now :+1:

rr-tom-noble commented 1 year ago

Closed in favour of https://github.com/ros2/common_interfaces/pull/218

tfoote commented 1 year ago

Thanks for jumping it over there.