automotive_navigation_msgs/DistanceToDestination Message

File: automotive_navigation_msgs/DistanceToDestination.msg

Raw Message Definition

# Distance To Destination Message
# Contains the distance to the desired destination

Header header

uint8 msg_counter   # Increments each time a command is sent
                    # An acknowledge message should be published with this value

float32 distance    # Distance to destination (m)


Compact Message Definition

std_msgs/Header header
uint8 msg_counter
float32 distance