ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
1

find position of object in a bag

asked 2017-03-24 05:13:48 -0500

Rai gravatar image

updated 2017-03-26 03:44:51 -0500

Hi guys,

I need to find(estimate) the 3D position of the 'people in the scene' -- (this is in the bag file) with respect to the camera.

My code is : (I didn't write it)

//ROS
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/image_encodings.h>
#include <image_transport/image_transport.h>
#include <cv_bridge/cv_bridge.h>
//OpenCV
#include <opencv2/opencv.hpp>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/highgui/highgui.hpp>
//BG SUBTRACTION
#include <opencv2/video/background_segm.hpp>

cv::Ptr<cv::BackgroundSubtractor> pMog;
cv::Mat fgMask;

void rgbCallback(const sensor_msgs::ImageConstPtr& msg)
{
  cv_bridge::CvImageConstPtr cv_ptr;
  try
  {
    cv_ptr = cv_bridge::toCvCopy(msg, sensor_msgs::image_encodings::BGR8);
  }
  catch (cv_bridge::Exception& ex)
  {
    ROS_ERROR("cv_bridge exception: %s", ex.what());
    exit(-1);
  }


  pMog->operator()(cv_ptr->image, fgMask);


  cv::imshow("RGB", cv_ptr->image);
  cv::imshow("FgMask", fgMask);
  cv::waitKey(30);
}


void depthCallback(const sensor_msgs::ImageConstPtr& msg)
{
  cv_bridge::CvImageConstPtr cv_ptr;
  try
  {
     cv_ptr = cv_bridge::toCvCopy(msg, 
                sensor_msgs::image_encodings::TYPE_32FC1);
  }
  catch (cv_bridge::Exception& ex)
  {
    ROS_ERROR("cv_bridge exception: %s", ex.what());
    exit(-1);
  }

  cv::imshow("DEPTH", cv_ptr->image);
  cv::waitKey(30);
}

int main(int argc, char **argv) {
    ros::init(argc, argv, "kinectgrabber");

    pMog = new cv::BackgroundSubtractorMOG(); //MOG Approach

    ros::NodeHandle n;
    ros::Subscriber sub = 
        n.subscribe("/camera/rgb/image_color", 1, rgbCallback);
    //ros::Subscriber depth = 
    //  n.subscribe("/camera/depth/image", 1, depthCallback);
    ros::spin();
    return 0;
}

I have a bag file (it's a short video with two man walking by) and I have to make the code read the bag file print out the 3D position of the people in the scene.

Any help is very much appreciated. Thank you in advance.

edit retag flag offensive close merge delete

1 Answer

Sort by ยป oldest newest most voted
1

answered 2017-03-24 05:51:42 -0500

The node doesn't need to know about the bag file. The code expects images on a topic. So, you just have to playback the bag file and subscribe to the right topic. See, here. You can also use the rqt_bag tool to examine the bag file.

edit flag offensive delete link more

Comments

thank you, and how do I estimate the pose?

Rai gravatar image Rai  ( 2017-03-25 01:11:35 -0500 )edit

I don't have personal experience with this. Maybe someone else can help you better.

nlamprian gravatar image nlamprian  ( 2017-03-25 03:14:03 -0500 )edit

Question Tools

1 follower

Stats

Asked: 2017-03-24 05:13:48 -0500

Seen: 275 times

Last updated: Mar 24 '17