Public Member Functions | Private Attributes
graph_slam::ScanMatchLocalization Class Reference

#include <scan_match_localization.h>

Inheritance diagram for graph_slam::ScanMatchLocalization:
Inheritance graph
[legend]

List of all members.

Public Member Functions

LocalizationState nextState (const LocalizationState &state, const Pose &fixed_frame_pose, const LaserPtr scan, const pose_graph::PoseGraph &graph, const NodePoseMap &optimized_poses) const
 Compute the next state given the current state, odom pose, scan, graph, and optimized poses.
 ScanMatchLocalization (const geometry_msgs::Pose2D &laser_offset, double neighborhood_size, const unsigned localizations_per_scan_match)
 Constructor.

Private Attributes

const unsigned localizations_per_scan_match_
KartoMatcherPtr matcher_
const double max_link_length_

Detailed Description

Definition at line 61 of file scan_match_localization.h.


Constructor & Destructor Documentation

graph_slam::ScanMatchLocalization::ScanMatchLocalization ( const geometry_msgs::Pose2D &  laser_offset,
double  neighborhood_size,
const unsigned  localizations_per_scan_match 
)

Constructor.

Parameters:
laser_offsetPose of laser in base frame
neighborhood_sizeSize (m) of neighborhood of current node used for scan matching
localizations_per_scan_matchDo scan matching every so many localizations

Definition at line 53 of file scan_match_localization.cpp.


Member Function Documentation

LocalizationState graph_slam::ScanMatchLocalization::nextState ( const LocalizationState state,
const Pose fixed_frame_pose,
const LaserPtr  scan,
const pose_graph::PoseGraph graph,
const NodePoseMap optimized_poses 
) const

Compute the next state given the current state, odom pose, scan, graph, and optimized poses.

Definition at line 59 of file scan_match_localization.cpp.


Member Data Documentation

Definition at line 85 of file scan_match_localization.h.

Definition at line 83 of file scan_match_localization.h.

Definition at line 80 of file scan_match_localization.h.


The documentation for this class was generated from the following files:


graph_slam
Author(s): Bhaskara Marthi
autogenerated on Tue Jan 7 2014 11:17:21