skohlbr / rtt_ros_control_example

An example of using ros_control with OROCOS RTT to (relatively) easily achieve hard real-time control capabilities.
21 stars 9 forks source link

rosnode to orocos component #1

Open cfpperche2 opened 8 years ago

cfpperche2 commented 8 years ago

Hello, I need help to transform a node ros into a component orocos. Why I need is turn this ros node file to a component orocos.

#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <sensor_msgs/image_encodings.h>
#include "RoadLineProcessing.hpp"

int main(int argc, char **argv)
{
  ros::init(argc, argv, "image_listener");
  ros::NodeHandle nh;

  image_transport::ImageTransport it(nh);
  RoadLineProcessing myRoad(nh);
  image_transport::Subscriber sub = it.subscribe("/image_raw", 1,boost::bind(&RoadLineProcessing::imageCallback, &myRoad, _1));
  ros::spin();
  return 0;
}

Exists any way to do this ?

Thanks.