, including all inherited members.
| addEdge(NodeId from, NodeId to, const PoseConstraint &constraint) | pose_graph::PoseGraphImpl | |
| addEdge(NodeId from, NodeId to, const PoseConstraint &constraint, EdgeId id) | pose_graph::PoseGraphImpl | |
| addNode() | pose_graph::PoseGraphImpl | |
| addNode(NodeId id) | pose_graph::PoseGraphImpl | |
| allEdges() const | pose_graph::PoseGraphImpl | |
| allNodes() const | pose_graph::PoseGraphImpl | |
| attachCloud(NodeId id, occupancy_grid_utils::LocalizedCloud::ConstPtr cloud) | pose_graph::PoseGraphImpl | |
| attachScan(NodeId id, sensor_msgs::LaserScan::ConstPtr cloud) | pose_graph::PoseGraphImpl | |
| clouds_ | pose_graph::PoseGraphImpl | [private] |
| constraints_ | pose_graph::PoseGraphImpl | [private] |
| dijkstra(const PoseGraphVertex &src) const | pose_graph::PoseGraphImpl | [private] |
| DijkstraResult typedef | pose_graph::PoseGraphImpl | [private] |
| DistanceMap typedef | pose_graph::PoseGraphImpl | [private] |
| edge_map_ | pose_graph::PoseGraphImpl | [private] |
| edgeIdExists(EdgeId id) const | pose_graph::PoseGraphImpl | |
| edgeLength(EdgeId id) const | pose_graph::PoseGraphImpl | |
| getCloud(NodeId id) const | pose_graph::PoseGraphImpl | |
| getConstraint(EdgeId id) const | pose_graph::PoseGraphImpl | |
| getInitialPoseEstimate(NodeId n) const | pose_graph::PoseGraphImpl | |
| getScan(NodeId id) const | pose_graph::PoseGraphImpl | |
| graph_ | pose_graph::PoseGraphImpl | [private] |
| hasCloud(NodeId id) const | pose_graph::PoseGraphImpl | |
| hasScan(NodeId id) const | pose_graph::PoseGraphImpl | |
| idEdge(EdgeId id) const | pose_graph::PoseGraphImpl | [private] |
| idVertex(NodeId id) const | pose_graph::PoseGraphImpl | [private] |
| incidentEdges(NodeId n) const | pose_graph::PoseGraphImpl | |
| incidentNodes(EdgeId e) const | pose_graph::PoseGraphImpl | |
| initializeFrom(const PoseGraphImpl &g) | pose_graph::PoseGraphImpl | [private] |
| nearbyNodes(NodeId src, double radius) const | pose_graph::PoseGraphImpl | |
| neighbors(NodeId n) const | pose_graph::PoseGraphImpl | |
| next_edge_id_ | pose_graph::PoseGraphImpl | [private] |
| next_node_id_ | pose_graph::PoseGraphImpl | [private] |
| nodeIdExists(NodeId id) const | pose_graph::PoseGraphImpl | |
| operator=(const PoseGraphImpl &g) | pose_graph::PoseGraphImpl | |
| otherNode(const NodeId n, const EdgeId e) const | pose_graph::PoseGraphImpl | |
| outsideRadius(NodeId n, double r, const DistanceMap &distances) const | pose_graph::PoseGraphImpl | [private] |
| PoseGraphImpl() | pose_graph::PoseGraphImpl | |
| PoseGraphImpl(const PoseGraphImpl &g) | pose_graph::PoseGraphImpl | |
| PredecessorMap typedef | pose_graph::PoseGraphImpl | [private] |
| relativePose(NodeId n, NodeId ref) const | pose_graph::PoseGraphImpl | |
| scans_ | pose_graph::PoseGraphImpl | [private] |
| setInitialPoseEstimate(NodeId n, const geometry_msgs::Pose &pose) | pose_graph::PoseGraphImpl | |
| shortestEdgeBetween(NodeId n1, NodeId n2) const | pose_graph::PoseGraphImpl | [private] |
| shortestPath(NodeId src, NodeId dest) const | pose_graph::PoseGraphImpl | |
| subgraph(const std::set< NodeId > &nodes) const | pose_graph::PoseGraphImpl | |
| vertex_map_ | pose_graph::PoseGraphImpl | [private] |