Go to the documentation of this file.
43 static const std::string
LOGNAME =
"occupancy_map_server";
47 octomap_msgs::Octomap map;
67 int main(
int argc,
char** argv)
69 ros::init(argc, argv,
"occupancy_map_server");
72 std::shared_ptr<tf2_ros::Buffer> buffer = std::make_shared<tf2_ros::Buffer>(
ros::Duration(5.0));
73 std::shared_ptr<tf2_ros::TransformListener> listener = std::make_shared<tf2_ros::TransformListener>(*buffer, nh);
#define ROS_ERROR_THROTTLE_NAMED(period, name,...)
static bool binaryMapToMsgData(const OctomapT &octomap, std::vector< int8_t > &mapData)
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
static void publishOctomap(ros::Publisher &octree_binary_pub, occupancy_map_monitor::OccupancyMapMonitor &server)
const std::string & getMapFrame() const
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(AdvertiseOptions &ops)
void startMonitor()
start the monitor (will begin updating the octomap
int main(int argc, char **argv)
void setUpdateCallback(const boost::function< void()> &update_callback)
Set the callback to trigger when updates to the maintained octomap are received.
const collision_detection::OccMapTreePtr & getOcTreePtr()
Get a pointer to the underlying octree for this monitor. Lock the tree before reading or writing usin...
static const std::string LOGNAME
occupancy_map_monitor
Author(s): Ioan Sucan
, Jon Binney , Suat Gedikli
autogenerated on Thu Nov 21 2024 03:24:13