topological_nav_msgs/TopologicalMapEdge Message

File: topological_nav_msgs/TopologicalMapEdge.msg

# Info stored with an edge in 2d topological map

# Id of this edge in the topological map
uint32 id

# Id of the source node
uint32 src

# Id of the destination node
uint32 dest

# Pose of origin of destination node's coordinate frame
# represented in the source node's coordinate frame
geometry_msgs/Pose offset

Expanded Definition

uint32 id
uint32 src
uint32 dest
geometry_msgs/Pose offset
    geometry_msgs/Point position
        float64 x
        float64 y
        float64 z
    geometry_msgs/Quaternion orientation
        float64 x
        float64 y
        float64 z
        float64 w