7 #include <nav_msgs/OccupancyGrid.h> 8 #include <nav_msgs/GetMap.h> 9 #include <geometry_msgs/PoseArray.h> 10 #include <geometry_msgs/PoseWithCovarianceStamped.h> 11 #include <nav2d_msgs/LocalizedScan.h> 19 #define ST_WAITING_FOR_MAP 10 20 #define ST_LOCALIZING 20 33 void receiveInitialPose(
const geometry_msgs::PoseWithCovarianceStamped::ConstPtr& pose);
36 bool getMap(nav_msgs::GetMap::Request &req, nav_msgs::GetMap::Response &res);
bool getMap(nav_msgs::GetMap::Request &req, nav_msgs::GetMap::Response &res)
nav_msgs::OccupancyGrid mGridMap
void setScanSolver(karto::ScanSolver *scanSolver)
void sendLocalizedScan(const sensor_msgs::LaserScan::ConstPtr &scan, const karto::Pose2 &pose)
ros::Subscriber mLaserSubscriber
ros::Subscriber mScanSubscriber
std::string mScanOutputTopic
SelfLocalizer * mSelfLocalizer
TFSIMD_FORCE_INLINE const tfScalar & y() const
std::string mScanInputTopic
ros::WallTime mLastMapUpdate
karto::SmartPointer< karto::OpenMapper > mMapper
ros::Publisher mVerticesPublisher
karto::LaserRangeFinderPtr mLaser
ros::Publisher mMapPublisher
void receiveLaserScan(const sensor_msgs::LaserScan::ConstPtr &scan)
ros::Publisher mScanPublisher
ros::Publisher mEdgesPublisher
tf::TransformListener mTransformListener
karto::LocalizedRangeScan * createFromRosMessage(const sensor_msgs::LaserScan &scan, const karto::Identifier &robot)
ros::Publisher mPosePublisher
tf::Transform mOdometryOffset
TFSIMD_FORCE_INLINE const tfScalar & x() const
ros::ServiceServer mMapServer
void onMessage(const void *sender, karto::MapperEventArguments &args)
ros::Subscriber mInitialPoseSubscriber
void setRobotPose(double x, double y, double yaw)
std::map< int, karto::LaserRangeFinderPtr > mOtherLasers
void receiveLocalizedScan(const nav2d_msgs::LocalizedScan::ConstPtr &scan)
ros::Publisher mOtherRobotsPublisher
tf::Transform mMapToOdometry
std::string mOdometryFrame
tf::TransformBroadcaster mTransformBroadcaster
void receiveInitialPose(const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &pose)