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

ixorim's profile - activity

2020-06-18 02:19:55 -0500 received badge  Famous Question (source)
2018-09-14 17:19:38 -0500 marked best answer velodyne VLP-32

I m having some troubles trying to write a launch file specific to the new velodyne VLP-32C. Thank you in advence

2018-03-08 12:36:13 -0500 received badge  Famous Question (source)
2018-01-09 07:29:36 -0500 marked best answer I created a package to load a .png to rviz but every time I add an image visualization to rviz and change the image topic, rivz crashes. does anyone see the problem ?
#include <ros/ros.h>
#include <sensor_msgs/image_encodings.h>
#include <image_transport/image_transport.h>
#include <opencv2/highgui/highgui.hpp>
#include <cv_bridge/cv_bridge.h>


int main(int argc, char** argv)
{
  ros::init(argc, argv, "image_publisher");
  ros::NodeHandle n;
  image_transport::ImageTransport it(n);
  image_transport::Publisher pub = it.advertise("/AS_logo", 1);
  cv::Mat image = cv::imread("/home/kamal/ROS_Work/1.png", CV_LOAD_IMAGE_COLOR);

 if( image.empty() )                      // Check for invalid input
{
    ROS_INFO("Could not open or find the image");
    return -1;
}


 sensor_msgs::ImagePtr msg = cv_bridge::CvImage(std_msgs::Header(), "bgr8", image).toImageMsg();

 ros::Rate loop_rate(1);
 while (n.ok()) {
   pub.publish(msg);
   ROS_INFO("ImageMsg Sent.");
   ROS_INFO("Subscribers: %d", pub.getNumSubscribers());
   ros::spinOnce();
   loop_rate.sleep();
 }

ros::spin();
return 0;

}

2018-01-09 07:29:33 -0500 received badge  Notable Question (source)
2018-01-08 20:46:59 -0500 commented question I created a package to load a .png to rviz but every time I add an image visualization to rviz and change the image topic, rivz crashes. does anyone see the problem ?

Thank you, I got it to work, it was the image size I had to resize it.

2018-01-08 14:32:28 -0500 received badge  Popular Question (source)
2018-01-08 11:59:07 -0500 asked a question I created a package to load a .png to rviz but every time I add an image visualization to rviz and change the image topic, rivz crashes. does anyone see the problem ?

I created a package to load a .png to rviz but every time I add an image visualization to rviz and change the image topi

2018-01-08 11:37:40 -0500 received badge  Enthusiast
2018-01-02 05:21:46 -0500 received badge  Notable Question (source)
2017-12-30 12:37:47 -0500 received badge  Popular Question (source)
2017-12-29 14:57:07 -0500 commented answer velodyne VLP-32

yes I have done that but it's for HDL-32E module. I have got the calibration file in the flash drive and everything but

2017-12-29 14:32:56 -0500 commented question velodyne VLP-32

ros-kinetic-velodyne

2017-12-29 06:48:55 -0500 asked a question velodyne VLP-32

velodyne VLP-32 I m having some troubles trying to write a launch file specific to the new velodyne VLP-32C. Thank you i

2017-12-28 23:52:35 -0500 commented answer How do I build ROS VLP16 Velodyne driver for Indigo using Catkin

http://velodynelidar.com/docs/manuals/63-9266%20REV%20A%20WEBSERVER%20USER%20GUIDE,HDL-32E%20&%20VLP-16.pdf