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

metal's profile - activity

2023-03-12 05:04:17 -0500 received badge  Famous Question (source)
2018-06-03 13:19:27 -0500 received badge  Famous Question (source)
2018-04-12 11:14:41 -0500 marked best answer Octomap volume estimation

Hello Everyone, I am trying to calculate the volume of octomap generated in octomap_server. Also I only want to calculate the volume containing occupied voxels(not the empty ones). Also some voxels overlap each other. So any thoughts on calculate the the volume?. Thank you.

2017-09-13 19:27:53 -0500 marked best answer Compilation error while installing Moveit from source

Hello everyone, I was trying to do source based installation of recently released "Moveit". When the installation reached 61% I am getting the following error:

[ 60%] Building CXX object moveit_ros/planning/trajectory_execution_manager/CMakeFiles/test_controller_manager.dir/test/test_app.cpp.o
Linking CXX shared library /home/karthik/groovy_workspace/moveit/devel/lib/libtest_controller_manager_plugin.so
/home/karthik/groovy_workspace/moveit/src/moveit_ros/planning/planning_scene_monitor/src/planning_scene_monitor.cpp: In member function ‘void planning_scene_monitor::PlanningSceneMonitor::excludeRobotLinksFromOctree()’:
/home/karthik/groovy_workspace/moveit/src/moveit_ros/planning/planning_scene_monitor/src/planning_scene_monitor.cpp:533:10: error: ‘class shapes::Mesh’ has no member named ‘mergeVertices’
[ 60%] Built target test_controller_manager_plugin
Linking CXX executable /home/karthik/groovy_workspace/moveit/devel/lib/moveit_ros_planning/test_controller_manager
[ 60%] Built target test_controller_manager
make[2]: *** [moveit_ros/planning/planning_scene_monitor/CMakeFiles/moveit_planning_scene_monitor.dir/src/planning_scene_monitor.cpp.o] Error 1
make[1]: *** [moveit_ros/planning/planning_scene_monitor/CMakeFiles/moveit_planning_scene_monitor.dir/all] Error 2
make: *** [all] Error 2
Invoking "make" failed

I tried uninstalling ROS,reinstalled it again without debian based moveit and it gives the same issue. Please help me on this.
I am working on *ROS-GROOVY *Ubuntu 12.04

2016-12-02 16:47:37 -0500 marked best answer How to read the x,y,z coordinates of point cloud from the LIDAR SICK LMS 200.

Goal: To employ obstacle avoidance by interpreting the data from the LIDAR using PCL

Description: Hi everyone, I am working with a LIDAR device for the first time. I used the sick toolbox ros wrapper for reading the values from the LIDAR. I converted the "scan" topic given out by the LIDAR device to point-cloud 2 format. here is the program:

#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <pcl/point_types.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl_ros/point_cloud.h>
#include <boost/foreach.hpp>
#include <pcl/io/pcd_io.h>
#include <tf/transform_listener.h>
#include <laser_geometry/laser_geometry.h>

 ros::Publisher pub;

class My_Filter {
     public:
        My_Filter();
        void scanCallback(const sensor_msgs::LaserScan::ConstPtr& scan);
     private:
        ros::NodeHandle node_;
        laser_geometry::LaserProjection projector_;
        tf::TransformListener tfListener_;

        ros::Publisher point_cloud_publisher_;
        ros::Subscriber scan_sub_;
         };

My_Filter::My_Filter(){
        scan_sub_ = node_.subscribe<sensor_msgs::LaserScan> ("/scan", 100, &My_Filter::scanCallback, this);
        point_cloud_publisher_ = node_.advertise<sensor_msgs::PointCloud2> ("/cloud", 100, false);
        tfListener_.setExtrapolationLimit(ros::Duration(0.1));
}

void My_Filter::scanCallback(const sensor_msgs::LaserScan::ConstPtr& scan){
    sensor_msgs::PointCloud2 cloud;

    projector_.transformLaserScanToPointCloud("/laser", *scan, cloud, tfListener_);
    point_cloud_publisher_.publish(cloud);
}



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

    My_Filter filter;

    ros::spin();

    return 0;
}

This above node gives out the point cloud 2 topic "cloud". I subscribed to this topic in the following program. I was successful in reading the widht and height of the point clouds,but I need some help reading the X,Y,Z coordinates. I also need to know how to access the other objects which might be useful in data processing.

#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <pcl/point_types.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl_ros/point_cloud.h>
#include <boost/foreach.hpp>
#include <pcl/io/pcd_io.h>
#include <tf/transform_listener.h>
#include <laser_geometry/laser_geometry.h>
#include <pcl/ros/conversions.h> 
ros::Publisher pub;
void cloud_cb (const sensor_msgs::PointCloud2ConstPtr& input)
{
  // ... do data processing
 printf ("Cloud: width = %d, height = %d\n", input->width,input->height);

  BOOST_FOREACH (const pcl::PointXYZ& pt, input->points)
  printf ("\t(%f, %f, %f)\n", pt.x, pt.y, pt.z);
  // Publish the data
 // pub.publish (output);
}

int main (int argc, char** argv)
{
  // Initialize ROS
  ros::init (argc, argv, "pcs200");
  ros::NodeHandle nh;

  // Create a ROS subscriber for the input point cloud
  ros::Subscriber sub = nh.subscribe ("/cloud", 100, cloud_cb);

  // Create a ROS publisher for the output point cloud
  pub = nh.advertise<sensor_msgs::PointCloud2> ("output", 100,false);

  // Spin
  ros::spin ();
}

Here is the output for that:

[  0%] Built target rospack_genmsg_libexe
  [  0%] Built target rosbuild_precompile
  Scanning dependencies of target pcs200
  [100%] Building CXX object CMakeFiles/pcs200.dir/src/pcs200.o
  /home/karthik/ros_workspace/pcs200/src/pcs200.cpp: In function ‘void cloud_cb(const sensor_msgs::PointCloud2ConstPtr&)’:
  /home/karthik/ros_workspace/pcs200/src/pcs200.cpp:17: error: ‘const struct sensor_msgs::PointCloud2_<std::allocator<void> >’ has no member named ‘points’
  /home/karthik/ros_workspace/pcs200/src/pcs200.cpp:17: error: ‘const struct sensor_msgs::PointCloud2_<std::allocator<void> >’ has no member named ‘points’
  /home/karthik/ros_workspace/pcs200/src/pcs200.cpp:17: error: ‘const struct sensor_msgs::PointCloud2_<std::allocator<void> >’ has ...
(more)
2016-11-30 10:19:46 -0500 received badge  Favorite Question (source)
2016-11-30 10:19:42 -0500 received badge  Nice Question (source)
2016-02-12 12:12:07 -0500 received badge  Famous Question (source)
2015-09-28 01:12:52 -0500 marked best answer PCL-ROS run time error while doing plane segmentation.

Hello everyone, I am trying to do plane segmentation using PCL and ROS. I am using the sensor Asus xtion pro live. I was able to launch openni_kinect and got the sensor pumping out necessary coordinates.

Here is my program:

ros::Publisher pub;
sensor_msgs::PointCloud2::Ptr downsampled,output;   



void cloud_cb (const sensor_msgs::PointCloud2ConstPtr& input)
{
pcl::PointCloud<pcl::pointxyz>::Ptr output_p(new pcl::PointCloud<pcl::pointxyz>);
pcl::PointCloud<pcl::pointxyz>::Ptr downsampled_XYZ(new pcl::PointCloud<pcl::pointxyz>);
 output_p->width  = 15;
  output_p->height = 1;
  output_p->points.resize (output_p->width * output_p->height);

downsampled_XYZ->width  = 15;
  downsampled_XYZ->height = 1;
  downsampled_XYZ->points.resize (output_p->width * output_p->height);


pcl::VoxelGrid<sensor_msgs::pointcloud2> sor;
sor.setInputCloud (input);
sor.setLeafSize (0.01f, 0.01f, 0.01f);
sor.filter (*downsampled);
// Change from type sensor_msgs::PointCloud2 to pcl::PointXYZ
pcl::fromROSMsg (*downsampled, *downsampled_XYZ);
pcl::ModelCoefficients::Ptr coefficients (new pcl::ModelCoefficients ());
pcl::PointIndices::Ptr inliers (new pcl::PointIndices ());
// Create the segmentation object
      pcl::SACSegmentation<pcl::pointxyz> seg;
      // Optional
      seg.setOptimizeCoefficients (true);
      // Mandatory
      seg.setModelType (pcl::SACMODEL_PLANE);
      seg.setMethodType (pcl::SAC_RANSAC);
      seg.setMaxIterations (1000);
      seg.setDistanceThreshold (0.01);

      // Create the filtering object
      pcl::ExtractIndices<pcl::pointxyz> extract;

      // Segment the largest planar component from the cloud
      seg.setInputCloud (downsampled_XYZ);
      seg.segment (*inliers, *coefficients);
      if (inliers->indices.size () == 0)
          {
              std::cerr << "Could not estimate a planar model for the given dataset." << std::endl;
              }

      // Extract the inliers
      extract.setInputCloud (downsampled_XYZ);
      extract.setIndices (inliers);
      extract.setNegative (false);
      extract.filter (*output_p);
      std::cerr << "PointCloud representing the planar component: " << output_p->width * output_p->height << " data points." << std::endl;

      // Create the filtering object
      // extract.setNegative (true);
      // extract.filter (*cloud_f);
      // cloud_filtered.swap (cloud_f);


      pcl::toROSMsg (*output_p, *output);

      //Publish the results
      pub.publish(output);

}



  // Publish the model coefficients



int main (int argc, char** argv)
{
  // Initialize ROS
  ros::init (argc, argv, "pcs200");
  ros::NodeHandle nh;

  // Create a ROS subscriber for the input point cloud
  ros::Subscriber sub = nh.subscribe ("/camera/depth/points", 100, cloud_cb);

  // Create a ROS publisher for the output point cloud
  pub = nh.advertise<sensor_msgs::pointcloud2> ("output/points", 100);

  // Spin
  ros::spin ();
}

so the run time error is:

: /usr/include/boost/smart_ptr/shared_ptr.hpp:412: boost::shared_ptr<t>::reference boost::shared_ptr<t>::operator*() const [with T = sensor_msgs::PointCloud2_<std::allocator<void> >, boost::shared_ptr<t>::reference = sensor_msgs::PointCloud2_<std::allocator<void> >&]: Assertion `px != 0' failed.
Aborted

I am aware of the shared pointer issue through this post http://answers.ros.org/question/39818/ros-pcl-run-time-error-segmenting-planes/ . As a matter of fact the code developed is based on this.

I know the answer is very near ,Can you guys please help me out on this?. Thanks.

regards,
Karthik

2015-06-15 21:48:09 -0500 received badge  Famous Question (source)
2015-03-16 13:28:41 -0500 received badge  Notable Question (source)
2015-03-08 23:15:21 -0500 received badge  Famous Question (source)
2015-03-06 00:05:40 -0500 received badge  Famous Question (source)
2015-03-05 13:16:52 -0500 answered a question Fitting line to pointcloud data

It works now!!. I was visualizing it wrongly. The trick is to take the rotation coefficients and convert it into quaternions, which is what RVIZ understands.

Here is the modified code snippet which does that:

        tf::Vector3 axis_vector(coefficients->values[3], coefficients->values[4], coefficients->values[5]);
        tf::Vector3 up_vector(1.0, 0.0, 0.0);
        tf::Vector3 right_vector = axis_vector.cross(up_vector);//
        right_vector.normalized();//
        tf::Quaternion q(right_vector, -1.0*acos(axis_vector.dot(up_vector)));//
        q.normalize();//
        geometry_msgs::Quaternion line_orientation;
        tf::quaternionTFToMsg(q, line_orientation);

Screenshot from 2015-03-05 13:09:42.png Screenshot from 2015-03-05 13:09:48.png

2015-02-23 13:07:20 -0500 received badge  Taxonomist
2015-02-19 10:44:39 -0500 received badge  Popular Question (source)
2015-02-19 10:44:39 -0500 received badge  Notable Question (source)
2015-02-19 10:44:39 -0500 received badge  Famous Question (source)
2015-02-05 10:08:39 -0500 received badge  Notable Question (source)
2015-01-12 02:54:43 -0500 received badge  Popular Question (source)
2015-01-09 02:40:22 -0500 received badge  Popular Question (source)
2015-01-08 18:19:40 -0500 asked a question Fitting line to pointcloud data

Hello Everyone, I am trying to fit a line to a point-cloud data received from a 2D lidar.

I am using random sample consus from pcl library to get this done. The first picture when the LIDAR is aligned with the wall, the line fits well. But when lidar is yawed the line deviates by certain degrees.

image description image description

Here is the code which does it:

 ros::Publisher marker_pub;
ros::Publisher pub;
ros::Publisher pub1;
visualization_msgs::Marker marker;
visualization_msgs::Marker text_1;
#define PI 3.14159265
using namespace std; 
float angle=0.0;
std::ostringstream tostr;
#include <sstream>    
void cloud_cb (const pcl::PCLPointCloud2ConstPtr& input)
{
        pcl::PCLPointCloud2::Ptr cloud_filtered (new pcl::PCLPointCloud2);
    pcl::PassThrough<pcl::PCLPointCloud2> pass_through_x;
        pcl::PassThrough<pcl::PCLPointCloud2> pass_through_y;

        pass_through_x.setInputCloud(input);
    // set fieldname we want to filter over
    pass_through_x.setFilterFieldName ("x");
    // set range for selected field to 1.0 - 1.5 meters
    pass_through_x.setFilterLimits (0.0,1.0);
    // do filtering
    pass_through_x.filter (*cloud_filtered);

    pass_through_y.setInputCloud (cloud_filtered);
    // set fieldname we want to filter over
    pass_through_y.setFilterFieldName ("y");
    // set range for selected field to 1.0 - 1.5 meters
    pass_through_y.setFilterLimits (0.0, 2.0);
    // do filtering
    pass_through_y.filter (*cloud_filtered); 

        pub.publish(*cloud_filtered);
    pcl::PointCloud< pcl::PointXYZ> cloud;
        pcl::fromPCLPointCloud2(*cloud_filtered, cloud);
        pcl::ModelCoefficients::Ptr coefficients (new pcl::ModelCoefficients);
    pcl::PointIndices::Ptr inliers (new pcl::PointIndices);
    // Create the segmentation object
    pcl::SACSegmentation<pcl::PointXYZ> seg;
    // Optional
    seg.setOptimizeCoefficients (true);
    // Mandatory
    seg.setModelType (pcl::SACMODEL_LINE);
    seg.setMethodType (pcl::SAC_RANSAC);
    seg.setDistanceThreshold (0.006);
    seg.setInputCloud (cloud.makeShared ());
    seg.segment (*inliers, *coefficients);

    if (inliers->indices.size () == 0)
    {
    PCL_ERROR ("Could not estimate a LINE model for the given dataset.");
    }
        angle=2*asin(coefficients->values[4])*180.0/PI;//formulae for quarternions.
    //std::cerr <<"deviation from the wall:"<<angle<<endl;

    tostr << angle; 
    text_1.ns = "vehicle_orientation";
    text_1.header.frame_id = "laser";
    text_1.header.stamp = ros::Time::now();
    text_1.type = visualization_msgs::Marker::TEXT_VIEW_FACING;
        text_1.action = visualization_msgs::Marker::ADD;
        text_1.pose.position.x =0.0;// coefficients->values[0];
        text_1.pose.position.y =-0.3;// coefficients->values[1];
        text_1.pose.position.z =0.0;// coefficients->values[2];
        text_1.pose.orientation.x = 0.0;
        text_1.pose.orientation.y = 0.0;
        text_1.pose.orientation.z = 0.0;
        text_1.pose.orientation.w = 1.0;
        text_1.id = 1;
        text_1.text=tostr.str();
        tostr.str("");

        text_1.scale.z = 0.12;
        text_1.color.r = 0.0f;
        text_1.color.g = 1.0f;
        text_1.color.b = 0.0f;
        text_1.color.a = 1.0f;
        text_1.lifetime = ros::Duration();
            marker_pub.publish(text_1);         

              marker.ns = "vehicle_orientation";
             marker.header.frame_id = "laser";
             marker.header.stamp = ros::Time::now();
             marker.type = visualization_msgs::Marker::ARROW;
            marker.action = visualization_msgs::Marker::ADD;
        marker.pose.position.x = coefficients->values[0];
        marker.pose.position.y = coefficients->values[1];
        marker.pose.position.z = coefficients->values[2];
        marker.pose.orientation.x = coefficients->values[3];
        marker.pose.orientation.y = coefficients->values[4];
        marker.pose.orientation.z = coefficients->values[5];
        marker.pose.orientation.w = 0.0;
        marker.id = 0;
        marker.scale.x = 0.6;
        marker.scale.y = 0.01;
        marker.scale.z = 0.01;
        // Set the color -- be sure to set alpha to something ...
(more)
2015-01-07 14:51:23 -0500 asked a question ROS Driver for Keyence SZ-16D safety Sensor

Hello Everyone, I am working on a Keyence 2D Lidar SZ-16D. The LIDAR communicates with the computer through RS-422A interface. I was wondering if someone has already written the ROS driver for it.

If not I would like to write one, it would be really great if someone with a experience of ROS driver development(for lidars)experience could show me the direction. Thank you

2014-12-09 08:48:24 -0500 received badge  Famous Question (source)
2014-12-07 15:41:38 -0500 received badge  Notable Question (source)
2014-12-06 15:47:03 -0500 received badge  Nice Question (source)
2014-12-06 15:38:10 -0500 received badge  Popular Question (source)
2014-12-05 17:55:22 -0500 asked a question Using the Navigation stack on a larger vehicle

Hello Everyone, I have a mobile robot(Rectangle size) of about 10X16 ft. I am trying to make it autonomous in an indoor area. The scene is not gonna be much cluttered. Imagine it is in pose A and I need it go to pose B.

I can get encoder data from the Omnidirectional wheels on the base and the laser scan data from the LIDAR. Could you please advise whether its advisable to move ahead with this package for this problem?. Also have anyone out there tried using ros navigation on a larger vehicle?. Please let me know, Thank you.

2014-11-24 00:59:33 -0500 received badge  Nice Question (source)
2014-11-23 03:24:01 -0500 received badge  Notable Question (source)
2014-11-23 03:24:01 -0500 received badge  Popular Question (source)
2014-08-26 16:02:37 -0500 received badge  Notable Question (source)
2014-07-03 07:28:12 -0500 received badge  Famous Question (source)
2014-06-10 09:57:19 -0500 received badge  Notable Question (source)
2014-05-30 02:44:23 -0500 received badge  Notable Question (source)
2014-05-29 15:23:01 -0500 received badge  Popular Question (source)
2014-04-20 13:20:58 -0500 marked best answer Calculating the distance between two planes in rviz

Hello everyone, I am working on a project to calculate the distance between the vehicle's base and the ground. I am working on Ubuntu 11.10 with ROS-electric(with PCL) and using Asus xtion pro live RGB-D sensor. I have successfully filtered two planes. Necessary for the foot placement of a humanoid robot. Here is the video: http://www.youtube.com/watch?v=6x4PLk89mig . Is there an easy way to calculate the distance between these two planes rather than me plugging in formula(or developing a ROS node) to calculate the distance between the planes.

thanks, karthik.

2014-04-20 13:16:54 -0500 marked best answer Trouble viewing Lidar data in rviz

Hello everyone,

I am working on a project where it requires for me to fuse lidar data and also the data from a stereo camera(bumblebee).

The main issue for now ,the Lidar data which is being viewed in rviz is not showing the coordinates in the z-axis. Please have a look at this video for more detailed picture of my project: http://www.youtube.com/watch?v=vCrcEc5B6p0&feature=g-crec-u . As you see towards the end of the video the point clouds are set flat on the screen. I want to be able to do 3D rendering like the PR2 does.

Also I am using the hokuyo Lidar(URG-04LX),Can it do the 3D rendering as I expect it to?. I think there is a need to have an on-board IMU for this problem. Please share your views. Thank you.

karthik

2014-04-20 13:01:55 -0500 marked best answer Implementing SLAM on a car-like robot using the navigation stack in ROS.

Hi everyone, I have been assigned to work on Ackermann type robot and my task is to make it autonomous and implement SLAM on it. I did consider ros-navigation stack and I came across this post http://answers.ros.org/question/9059/how-can-i-use-the-navigation-stack-on-a-carlike/.

Before I shoot out my questions,I would like to give a picture of whats going on. here is video for my robot:http://www.youtube.com/watch?v=8fZYF8Zn3zA

Components of the robot: 1.sdc2130 motor driver 2.encoders from US digital 3.SICK LIDAR(LMS-200) 4.2 lead acid(12 V ) batteries. 5.2 DC motors

Goals: 1.To achieve SLAM in unkown environment and also to achieve autonomous navigation and obstacle avoidance.

Tasks accomplished: 1.Developed a ros node for the motor control as shown in the video. 2.Developed a ros node for reading the encoder values and pumping out the data to the odometry node.

Things yet to be done: 1.identifying the ideal motion primitive and implementing it in the ros-navigation(which I have no clue how to start). 2. Rewriting the local planner.

Questions: 1. I would like to know whether the navigation stack could be implemented successfully in this type of robot. 2.Is there any other approach in ROS to achieve SLAM in this type of robot?.

I am aware that the files trajectory_planner.cpp ,trajectory_planner.h(Local planner) in navigation/base_local_planner are the ones which need editing. I also need to know how to choose the right motion primitives in SBPL and how to implement it in ros navigation stack.

Please share your views on this. Thanks for your time.

regards, Karthikeyan Yuvaraj

2014-04-20 12:55:55 -0500 marked best answer Issues controlling the motor controller "Roboteq’s SDC2130" using ROS serial.

Hey guys, I need your perspective on the problem,I am facing. I tried to connect with the motor controller SDC2130(from Robotech). Here is the error,I am getting :

>>rosrun rosserial_python serial_node.py

[INFO] [WallTime: 1340943422.708854] ROS Serial Python Node [INFO] [WallTime: 1340943422.713271] Connected on /dev/ttyACM0 at 115200 baud [ERROR] [WallTime: 1340943424.826012] Failed to parse publisher: unpack requires a string argument of length 2 [ERROR] [WallTime: 1340943437.722695] Lost sync with device, restarting... [ERROR] [WallTime: 1340943437.733680] Failed to parse publisher: unpack requires a string argument of length 2

Is ros serial tuned to work only with arduino boards?. Do I need to interface the arduino board in order to use ros serial for communicating with the motor controller?. Please share your views. Thank you.

2014-04-20 12:46:08 -0500 marked best answer trouble creating launch file

hello Guys , I am trying to create a launch file which would execute the command:

rosrun ardrone_brown ardrone_driver

so here is the launch file: <launch> <node name="ardrone_driver" pkg="ardrone_brown" type="ardrone_driver"/> </launch>

roslaunch ardrone_brown ardronematlab.launch

and here is the corresponding output when I execute the launch file::

... logging to /home/karthik/.ros/log/88e084e4-84d4-11e1-a4e9-f04da263aca7/roslaunch-karthik-laptop-6444.log
Checking log directory for disk usage. This may take awhile.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.
started roslaunch server http://karthik-laptop:47029/
SUMMARY
========
PARAMETERS
 * /rosversion
 * /rosdistro
NODES
  /
    ardrone_driver (ardrone_brown/ardrone_driver)
ROS_MASTER_URI=http://localhost:11311
core service [/rosout] found
process[ardrone_driver-1]: started with pid [6462]
[ardrone_driver-1] process has died [pid 6462, exit code 255].
log files: /home/karthik/.ros/log/88e084e4-84d4-11e1-a4e9-f04da263aca7/ardrone_driver-1*.log
all processes on machine have died, roslaunch will exit
shutting down processing monitor...
... shutting down processing monitor complete
done

please give your prespective on this

2014-04-20 12:28:00 -0500 marked best answer How to make opencv and ROS work together?

I have been stuck on this issue for days .I am trying to access image using ros and then do simple opencv algorithms like canny edge.

I do cmake and when I rosmake this particular issue keeps rising from cv_bridge.H. "//usr/local/lib/libopencv_gpu.so.2.3: undefined reference to `cv::gpu::GpuMat::release()'"

I installed the CUDA driver and it says the same error again.What am I doing wrong here? I thought ROS and OPENCV are compatible but it does not seem like that seem that all.

Please share your perspective.

2014-04-20 12:27:57 -0500 marked best answer Executable not found in /bin directory

Hi guys, I am trying to make ROS and the opencv work together for bringing up the edge detection on a quadrotor called the ardrone. The code compiled successfully and was built using rosmake with 0 failures. But driver file was to found in the bin which was created.

I am using ROS-electric,ubuntu 10.10 Any suggestion please. This is my rosmake output:

[ rosmake ] No package specified. Building ['ardrone_kar']
[ rosmake ] Packages requested are: ['ardrone_kar']
[ rosmake ] Logging to directory/home/metallo/.ros/rosmake/rosmake_output-20120209-145539 [ rosmake ] Expanded args ['ardrone_kar'] to: ['ardrone_kar']
[ rosmake ] Checking rosdeps compliance for packages ardrone_kar. This may take a few seconds. [ rosmake ] rosdep check passed all system dependencies in packages
[rosmake-0] Starting >>> rosbuild [ make ]
[rosmake-0] Finished <<< rosbuild ROS_NOBUILD in package rosbuild No Makefile in package rosbuild [rosmake-1] Starting >>> cpp_common [ make ]
[rosmake-1] Finished <<< cpp_common ROS_NOBUILD in package cpp_common
[rosmake-2] Starting >>> roslib [ make ]
[rosmake-2] Finished <<< roslib ROS_NOBUILD in package roslib
[rosmake-3] Starting >>> opencv2 [ make ]
[rosmake-0] Starting >>> roslang [ make ]
[rosmake-1] Starting >>> roscpp_traits [ make ]
[rosmake-2] Starting >>> rostime [ make ]
[rosmake-0] Finished <<< roslang ROS_NOBUILD in package roslang No Makefile in package roslang [rosmake-0] Starting >>> xmlrpcpp [ make ]
[rosmake-1] Finished <<< roscpp_traits ROS_NOBUILD in package roscpp_traits
[rosmake-1] Starting >>> std_msgs [ make ]
[rosmake-2] Finished <<< rostime ROS_NOBUILD in package rostime
[rosmake-2] Starting >>> roscpp_serialization [ make ]
[rosmake-1] Finished <<< std_msgs ROS_NOBUILD in package std_msgs
[rosmake-0] Finished <<< xmlrpcpp ROS_NOBUILD in package xmlrpcpp
[rosmake-0] Starting >>> rosconsole [ make ]
[rosmake-2] Finished <<< roscpp_serialization ROS_NOBUILD in package roscpp_serialization [rosmake-2] Starting >>> rosclean [ make ]
[rosmake-3] Finished <<< opencv2 ROS_NOBUILD in package opencv2
[rosmake-1] Starting >>> rosgraph_msgs [ make ]
[rosmake-0] Finished <<< rosconsole ROS_NOBUILD in package rosconsole
[rosmake-3] Starting >>> rosgraph [ make ]
[rosmake-0] Starting >>> rosparam [ make ]
[rosmake-2] Finished <<< rosclean ROS_NOBUILD in package rosclean
[rosmake-1] Finished <<< rosgraph_msgs ROS_NOBUILD in package rosgraph_msgs
[rosmake-1] Starting >>> roscpp [ make ]
[rosmake-2] Starting >>> rosmaster [ make ]
[rosmake-0] Finished <<< rosparam ROS_NOBUILD in package rosparam
[rosmake-3] Finished <<< rosgraph ROS_NOBUILD in package rosgraph
[rosmake-2] Finished <<< rosmaster ROS_NOBUILD in package rosmaster
[rosmake-3] Starting >>> rospy [ make ]
[rosmake-2] Starting >>> rosunit [ make ]
[rosmake-1] Finished <<< roscpp ROS_NOBUILD in package roscpp
[rosmake-1] Starting >>> rosout [ make ]
[rosmake-0] Starting >>> pluginlib [ make ]
[rosmake-3] Finished <<< rospy ROS_NOBUILD in package rospy
[rosmake-1] Finished <<< rosout ROS_NOBUILD in package rosout
[rosmake-0] Finished <<< pluginlib ROS_NOBUILD in package pluginlib
[rosmake-2] Finished <<< rosunit ROS_NOBUILD in package rosunit
[rosmake-1] Starting >>> roslaunch [ make ]
[rosmake-1] Finished <<< roslaunch ROS_NOBUILD in package roslaunch No Makefile in package roslaunch [rosmake-1] Starting >>> rostest [ make ]
[rosmake-1] Finished <<< rostest ROS_NOBUILD in package rostest
[rosmake-1] Starting >>> topic_tools [ make ]
[rosmake-1] Finished <<< topic_tools ROS_NOBUILD in package topic_tools
[rosmake-1] Starting >>> rosbag [ make ]
[rosmake-2] Starting >>> message_filters [ make ]
[rosmake-1] Finished <<< rosbag ROS_NOBUILD in package rosbag
[rosmake-2] Finished <<< message_filters ROS_NOBUILD in package message_filters [rosmake-1] Starting >>> rosbagmigration [ make ]
[rosmake-1] Finished <<< rosbagmigration ROS_NOBUILD in package rosbagmigration No Makefile in package rosbagmigration [rosmake-1] Starting >>> geometry_msgs [ make ]
[rosmake-1] Finished <<< geometry_msgs ROS_NOBUILD in package geometry_msgs
[rosmake-1] Starting >>> sensor_msgs [ make ]
[rosmake-1] Finished <<< sensor_msgs ROS_NOBUILD in package sensor_msgs
[rosmake-1] Starting >>> image_transport [ make ]
[rosmake-2] Starting >>> cv_bridge [ make ]
[rosmake-1] Finished <<< image_transport ROS_NOBUILD in package image_transport [rosmake-2] Finished <<< cv_bridge ROS_NOBUILD in package cv_bridge
[rosmake-1] Starting >>> ardrone_kar [ make ]
[rosmake-1] Finished <<< ardrone_kar [PASS] [ 0.19 seconds ]
[ rosmake ] Results:
[ rosmake ] Built 33 packages with 0 failures.
[ rosmake ] Summary output to directory
[ rosmake ] /home ...
(more)

2014-04-20 12:27:50 -0500 marked best answer problem with opencv and cv_bridge

hi guys ,I am trying to interface ROS(diamondback) and opencv. I am working on ubuntu 10.04 . I followed the tutorial in the following link

http://www.ros.org/wiki/cv_bridge/Tutorials/UsingCvBridgeToConvertBetweenROSImagesAndOpenCVImages

I created a package with the following dependencies sensor_msgs,image_transport,opencv2,cv_bridge,roscpp,std_msgs.

I used the same program in the link above and copied it to the "src" folder as a CPP file. I compiled it using rosmake (after being done with cmake). This was my output:

[ rosmake ] No package specified. Building ['ardrone_kar']
[ rosmake ] Packages requested are: ['ardrone_kar']
[ rosmake ] Logging to directory/home/metallo/.ros/rosmake/rosmake_output-20120202-043021 [ rosmake ] Expanded args ['ardrone_kar'] to: ['ardrone_kar']
[ rosmake ] Checking rosdeps compliance for packages ardrone_kar. This may take a few seconds. Failed to find rosdep opencv2 for package ardrone_kar on OS:ubuntu version:10.10 WARNING: Rosdeps [u'opencv2'] could not be resolved [ rosmake ] rosdep check passed all system dependencies in packages
[rosmake-0] Starting >>> roslib [ make ]
[rosmake-0] Finished <<< roslib ROS_NOBUILD in package roslib
[rosmake-1] Starting >>> rosbuild [ make ]
[rosmake-1] Finished <<< rosbuild ROS_NOBUILD in package rosbuild No Makefile in package rosbuild [rosmake-2] Starting >>> cpp_common [ make ]
[rosmake-2] Finished <<< cpp_common ROS_NOBUILD in package cpp_common
[rosmake-3] Starting >>> xmlrpcpp [ make ]
[rosmake-0] Starting >>> std_msgs [ make ]
[rosmake-1] Starting >>> roslang [ make ]
[rosmake-2] Starting >>> roscpp_traits [ make ]
[rosmake-3] Finished <<< xmlrpcpp ROS_NOBUILD in package xmlrpcpp
[rosmake-1] Finished <<< roslang ROS_NOBUILD in package roslang No Makefile in package roslang [rosmake-0] Finished <<< std_msgs ROS_NOBUILD in package std_msgs
[rosmake-1] Starting >>> rostime [ make ]
[rosmake-2] Finished <<< roscpp_traits ROS_NOBUILD in package roscpp_traits
[rosmake-1] Finished <<< rostime ROS_NOBUILD in package rostime
[rosmake-0] Starting >>> rosgraph_msgs [ make ]
[rosmake-3] Starting >>> roscpp_serialization [ make ]
[rosmake-2] Starting >>> rosconsole [ make ]
[rosmake-0] Finished <<< rosgraph_msgs ROS_NOBUILD in package rosgraph_msgs
[rosmake-3] Finished <<< roscpp_serialization ROS_NOBUILD in package roscpp_serialization [rosmake-2] Finished <<< rosconsole ROS_NOBUILD in package rosconsole
[rosmake-1] Starting >>> rosclean [ make ]
[rosmake-0] Starting >>> rospy [ make ]
[rosmake-3] Starting >>> roscpp [ make ]
[rosmake-0] Finished <<< rospy ROS_NOBUILD in package rospy
[rosmake-3] Finished <<< roscpp ROS_NOBUILD in package roscpp
[rosmake-1] Finished <<< rosclean ROS_NOBUILD in package rosclean
[rosmake-2] Starting >>> rosgraph [ make ]
[rosmake-2] Finished <<< rosgraph ROS_NOBUILD in package rosgraph
[rosmake-0] Starting >>> rosparam [ make ]
[rosmake-0] Finished <<< rosparam ROS_NOBUILD in package rosparam
[rosmake-1] Starting >>> rosmaster [ make ]
[rosmake-1] Finished <<< rosmaster ROS_NOBUILD in package rosmaster
[rosmake-3] Starting >>> rosout [ make ]
[rosmake-3] Finished <<< rosout ROS_NOBUILD in package rosout
[rosmake-2] Starting >>> rosunit [ make ]
[rosmake-2] Finished <<< rosunit ROS_NOBUILD in package rosunit
[rosmake-0] Starting >>> tinyxml [ make ]
[rosmake-0] Finished <<< tinyxml ROS_NOBUILD in package tinyxml
[rosmake-3] Starting >>> roslaunch [ make ]
[rosmake-1] Starting >>> opencv2 [ make ]
[rosmake-2] Starting >>> pluginlib [ make ]
[rosmake-3] Finished <<< roslaunch ROS_NOBUILD in package roslaunch No Makefile in package roslaunch [rosmake-2] Finished <<< pluginlib ROS_NOBUILD in package pluginlib
[rosmake-3] Starting >>> rostest [ make ]
[rosmake-3] Finished <<< rostest ROS_NOBUILD in package rostest
[rosmake-3] Starting >>> topic_tools [ make ]
[rosmake-3] Finished <<< topic_tools ROS_NOBUILD in package topic_tools
[rosmake-3] Starting >>> rosbag [ make ]
[rosmake-0] Starting >>> message_filters [ make ]
[rosmake-1] Finished <<< opencv2 [PASS] [ 0.02 seconds ]
[rosmake-3] Finished <<< rosbag ROS_NOBUILD in package rosbag
[rosmake-3] Starting >>> rosbagmigration [ make ]
[rosmake-0] Finished <<< message_filters ROS_NOBUILD in package message_filters [rosmake-3] Finished <<< rosbagmigration ROS_NOBUILD in package rosbagmigration No Makefile in package rosbagmigration [rosmake-3] Starting >>> geometry_msgs [ make ]
[rosmake-3] Finished <<< geometry_msgs ROS_NOBUILD in package geometry_msgs
[rosmake-3] Starting >>> sensor_msgs [ make ]
[rosmake-3] Finished <<< sensor_msgs ROS_NOBUILD in ... (more)