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

actionlib_msgs: add_action_files takes absolute paths for DIRECTORY a… #96

Closed mrjogo closed 6 years ago

mrjogo commented 7 years ago

…rgument. This matches behavior of add_message_files and add_service_files. It implements in jade-devel the functionality of seemingly-abandoned PR ros/common_msgs#43.

Note that the .action file install path was updated to match messages and services, however that means that absolute DIRECTORY paths are installed relative to CATKIN_PACKAGE_SHARE_DESTINATION (ie, /usr/src/myactionfiles ends up in /opt/ros/jade/share/mypackage/usr/src/myactionfiles). Not sure if this is desired behavior or a bug.