32 #include <sensor_msgs/Image.h> 33 #include <sensor_msgs/CompressedImage.h> 35 #include <sensor_msgs/CameraInfo.h> 45 #include <opencv2/highgui/highgui.hpp> 47 #include <boost/thread.hpp> 49 #include "rtabmap_ros/RGBDImage.h" 90 bool approxSync =
false;
91 pnh.
param(
"approx_sync", approxSync, approxSync);
92 pnh.
param(
"queue_size", queueSize, queueSize);
121 std::string subscribedTopicsMsg =
uFormat(
"\n%s subscribed to (%s sync):\n %s \\\n %s",
123 approxSync?
"approx":
"exact",
131 void warningLoop(
const std::string & subscribedTopicsMsg,
bool approxSync)
139 ROS_WARN(
"%s: Did not receive data since 5 seconds! Make sure the input topics are " 140 "published (\"$ rostopic hz my_topic\") and the timestamps in their " 141 "header are set. %s%s",
143 approxSync?
"":
"Parameter \"approx_sync\" is false, which means that input " 144 "topics should have all the exact timestamp for the callback to be called.",
145 subscribedTopicsMsg.c_str());
151 const sensor_msgs::ImageConstPtr& image,
152 const sensor_msgs::CameraInfoConstPtr& cameraInfo)
157 double stamp = image->header.stamp.toSec();
159 rtabmap_ros::RGBDImage msg;
160 msg.header.frame_id = cameraInfo->header.frame_id;
161 msg.header.stamp = image->header.stamp;
162 msg.rgb_camera_info = *cameraInfo;
166 bool publishCompressed =
true;
172 publishCompressed =
false;
176 if(publishCompressed)
180 rtabmap_ros::RGBDImage msgCompressed = msg;
183 imagePtr->toCompressedImageMsg(msgCompressed.rgb_compressed,
cv_bridge::JPG);
195 if( stamp != image->header.stamp.toSec())
197 NODELET_ERROR(
"Input stamps changed between the beginning and the end of the callback! Make " 198 "sure the node publishing the topics doesn't override the same data after publishing them. A " 199 "solution is to use this node within another nodelet manager. Stamps: " 201 stamp, image->header.stamp.toSec());
boost::thread * warningThread_
message_filters::sync_policies::ApproximateTime< sensor_msgs::Image, sensor_msgs::CameraInfo > MyApproxSyncPolicy
CvImageConstPtr toCvShare(const sensor_msgs::ImageConstPtr &source, const std::string &encoding=std::string())
std::string getTopic() const
std::string uFormat(const char *fmt,...)
#define NODELET_ERROR(...)
void publish(const boost::shared_ptr< M > &message) const
void callback(const sensor_msgs::ImageConstPtr &image, const sensor_msgs::CameraInfoConstPtr &cameraInfo)
message_filters::sync_policies::ExactTime< sensor_msgs::Image, sensor_msgs::CameraInfo > MyExactSyncPolicy
message_filters::Synchronizer< MyExactSyncPolicy > * exactSync_
std::string resolveName(const std::string &name, bool remap=true) const
void warningLoop(const std::string &subscribedTopicsMsg, bool approxSync)
const std::string & getName() const
message_filters::Subscriber< sensor_msgs::CameraInfo > cameraInfoSub_
ros::NodeHandle & getPrivateNodeHandle() const
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ros::NodeHandle & getNodeHandle() const
void subscribe(ImageTransport &it, const std::string &base_topic, uint32_t queue_size, const TransportHints &transport_hints=TransportHints())
image_transport::SubscriberFilter imageSub_
#define NODELET_INFO(...)
uint32_t getNumSubscribers() const
ros::Time lastCompressedPublished_
void subscribe(ros::NodeHandle &nh, const std::string &topic, uint32_t queue_size, const ros::TransportHints &transport_hints=ros::TransportHints(), ros::CallbackQueueInterface *callback_queue=0)
message_filters::Synchronizer< MyApproxSyncPolicy > * approxSync_
PLUGINLIB_EXPORT_CLASS(rtabmap_ros::CoreWrapper, nodelet::Nodelet)
#define NODELET_DEBUG(...)
std::string getTopic() const
ros::Publisher rgbdImageCompressedPub_
ros::Publisher rgbdImagePub_