dynamic_obs_msgs/DynamicObstacle Message

File: dynamic_obs_msgs/DynamicObstacle.msg

#the radius of the dynamic obstacle
float64 radius

#a list of possible trajectories it may follow (with probabilities summing to 1)
DynObsTrajectory[] trajectories

Expanded Definition

float64 radius
DynObsTrajectory[] trajectories
    float64 probability
    bool exists_after
    geometry_msgs/PoseWithCovarianceStamped[] points
        Header header
            uint32 seq
            time stamp
            string frame_id
        geometry_msgs/PoseWithCovariance pose
            geometry_msgs/Pose pose
                geometry_msgs/Point position
                    float64 x
                    float64 y
                    float64 z
                geometry_msgs/Quaternion orientation
                    float64 x
                    float64 y
                    float64 z
                    float64 w
            float64[36] covariance