Public Member Functions | |
bool | octomapBinarySrv (GetOctomap::Request &req, GetOctomap::Response &res) |
bool | octomapFullSrv (GetOctomap::Request &req, GetOctomap::Response &res) |
OctomapServerStatic (const std::string &filename) | |
~OctomapServerStatic () | |
Private Attributes | |
ros::NodeHandle | m_nh |
ros::ServiceServer | m_octomapBinaryService |
ros::ServiceServer | m_octomapFullService |
AbstractOccupancyOcTree * | m_octree |
std::string | m_worldFrameId |
Definition at line 44 of file octomap_server_static.cpp.
OctomapServerStatic::OctomapServerStatic | ( | const std::string & | filename | ) | [inline] |
Definition at line 46 of file octomap_server_static.cpp.
OctomapServerStatic::~OctomapServerStatic | ( | ) | [inline] |
Definition at line 95 of file octomap_server_static.cpp.
bool OctomapServerStatic::octomapBinarySrv | ( | GetOctomap::Request & | req, |
GetOctomap::Response & | res | ||
) | [inline] |
Definition at line 100 of file octomap_server_static.cpp.
bool OctomapServerStatic::octomapFullSrv | ( | GetOctomap::Request & | req, |
GetOctomap::Response & | res | ||
) | [inline] |
Definition at line 112 of file octomap_server_static.cpp.
ros::NodeHandle OctomapServerStatic::m_nh [private] |
Definition at line 128 of file octomap_server_static.cpp.
Definition at line 127 of file octomap_server_static.cpp.
Definition at line 127 of file octomap_server_static.cpp.
Definition at line 130 of file octomap_server_static.cpp.
std::string OctomapServerStatic::m_worldFrameId [private] |
Definition at line 129 of file octomap_server_static.cpp.