common_interfaces icon indicating copy to clipboard operation
common_interfaces copied to clipboard

A set of packages which contain common interface files (.msg and .srv).

Results 55 common_interfaces issues
Sort by recently updated
recently updated
newest added

Hello, I have been doing some work on the nav2 stack @SteveMacenski and I wanted to add in a cost attribute to the Path.msg. This change will help https://github.com/ros-planning/navigation2/issues/2880. Cheers,...

Fixes #180 As stated in the original issue, the Range msg lacks the variance field as opposed to most sensor msgs. A similar issue exist for ros1, and here the...

more-information-needed

## Feature request The `sensor_msgs/Image` currently uses the `encoding` field to document how the raw data in the `data` field has to be interpreted. The fourcc (4 character code) is...

more-information-needed

I'm talking about the safety scanners that have fields of different shapes and output whether an obstacle is detected within that field. What is your opinion on having a standard...

backlog

## Bug report When the NavSatStatus.msg is default constructed, status = 0 which by definition is an unaugmented fix as opposed to NO_FIX (or even better something like UNKNOWN) ####...

Signed-off-by: Sarthak Mittal As per https://github.com/ros2/rviz/issues/538 and https://github.com/ros-planning/navigation2/issues/1623, I propose adding ~`nav_msgs/Particle` and `nav_msgs/ParticleCloud`~ `nav_msgs/PoseParticle` and `nav_msgs/PoseParticleCloud` messages to represent particles/particle clouds produced by particle filters.

The current version of SolidPrimitive.msg looks like: https://github.com/ros2/common_interfaces/blob/b7e2ad503e1648468b1dc766c43aac12cc9aee5a/shape_msgs/msg/SolidPrimitive.msg . If you look closely at that message, though, it has two problems: 1. The messages share very little infrastructure with each...

backlog

## Feature request #### Feature description Lidar point clouds continue to grow and visualizing lidar point in realtime can use a lot of data. Practical amount using for example 4...

help wanted

Hi, I know this discussion has come up before, but it has once more come to my attention that `Pose2D` is an important message type which is used widely and...

more-information-needed

Hi, As previously asked by @okalachev in the ros1 counterpart: https://github.com/ros/common_msgs/issues/142 > All the sensor related messages have variance/covariance field: FluidPressure, Illuminance, Imu, MagneticField, NavSatFix, RelativeHumidity, Temperature; while Range lacks...

help wanted