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
179 stars 191 forks source link

add ARROW_LIST to visualization_msgs/Marker #135

Open christian-rauch opened 5 years ago

christian-rauch commented 5 years ago

The visualization_msgs/Marker should add a type for lists of arrows. The message definition already has types for lists for spheres, cubes and lines. The types appear inconsistent since spheres and cubes exist as single and list version, but the line only exist as list version and the arrow and the cylinder only exist as single version. Having all basic shapes as single and list version would be more consistent.

The closest to ARROW_LIST is LINE_LIST, but the line does not visualise the direction, i.e. the start and end point. The line is also just visualised as 2D rectangle with the normal oriented towards the camera view.

tfoote commented 5 years ago

An arrow field support does sound like it would be valuable. To work toward this I'd suggest tat you put together a coordinated PR both here and to the rviz Marker display for a coordinated review.

LemonPi commented 1 year ago

Any luck with this?

rr-tom-noble commented 1 year ago

Similar PR implemented for ROS1 here (adds ARROW_STRIP, more similar to LINE_STRIP in that the arrows are defined tip to tail):

https://github.com/ros/common_msgs/pull/190 https://github.com/ros-visualization/rviz/pull/1786

The suggestion was to implement for ROS2 first, then backport, so there's a corresponding set of PRs currently open:

https://github.com/ros2/common_interfaces/pull/218 https://github.com/ros2/rviz/pull/972

Latter PR is in progress as I'm waiting for answers from someone with more experience with rviz2 for help porting over some of the non-obvious ROS1->ROS2 changes. The repo seems less active compared to rviz1 in terms of getting a response. Slighlty frustrating as I could finish off the PRs in a day or so once I have those answers. Any help getting them resolved would be much appreciated.