Only released in EOL distros:  

Package Summary

Implements a localizing jockey for the Large Maps framework (LaMa) based on a local costmap (costmap position is relative to the sensor but orientation is absolute). Implement a localizing jockey from a LaserScan. The associated descriptors are LaserScan[] and Crossing.

Overview

The lj_costmap package is a localizing jockey for the Large Maps Framework (LaMa) that computes place dissimilarities based on a local cost map, such as those obtained from the local_map package.

The role of this jockey is to get the dissimilarity of the lama_msgs/PlaceProfile descriptors of all vertices with the current place profile. The action is done when the dissimilarities are computed. Implemented actions:

  • GET_VERTEX_DESCRIPTOR: return the PlaceProfile and the computed Crossing

  • GET_SIMILARITY: return the dissimilarity based on PlaceProfile

Usage

ROS API

Interaction with the map (created by this jockey)

[Getter][/][Setter]

message type

interface default name

Getter/Setter

lama_msgs/PlaceProfile

jockey_name + "_place_profile"

Setter

lama_msgs/Crossing

jockey_name + "_crossing"

Subscribed Topics

~<name>/local_costmap (nav_msgs/OccupancyGrid)
  • local cost map which orientation is global, cf. local_map.

Services

~<name>/dissimilarity_server (polygon_matcher/PolygonDissimilarity)
  • used to compare all known places (as polygons) with the current place.

Parameters

~<name>/costmap_interface_name (String, default: jockey_name + "_place_profile")
  • Name of the map interface for place profiles.
~<name>/crossing_interface_name (String, default: jockey_name + "_crossing")
  • Name of the map interface for crossings.
~<name>/dissimilarity_server_name (String, default: "dissimilarity_server")
  • Name of the dissimilarity server.

Wiki: lj_costmap (last edited 2015-01-05 15:12:45 by GaelEcorchard)