topological_nav_msgs/TopologicalGraph Message

File: topological_nav_msgs/TopologicalGraph.msg

# A 2d topological map consists of a set of local occupancy grids together with
# the transformations between coordinate frames of overlapping grids.  This ROS
# message represents the structure of the topological map, i.e., all the 
# information except the grids themselves.  You can get individual grids by
# calling the GetLocalGrid service on the mapper.

TopologicalMapNode[] nodes
TopologicalMapEdge[] edges

Expanded Definition

TopologicalMapNode[] nodes
    uint32 id
    float32 x_size
    float32 y_size
    float32 resolution
TopologicalMapEdge[] edges
    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