Does ROS support 2D image to 3D scene inference?
Does ROS have a service that does this without any depth Data?
View Articlewhat are the current state-of-the-art SLAM algorithms for these scenarios?
Hi, Have found that SLAM is not an algorithm but a framework for localization and mapping. After searching, found that it has been around for 30 years and many approaches have been taken to solve the...
View Articlegeometry_msgs/Vector2 ?
Is there an extension of `geometry_msgs` including 2D types, such as `geometry_msgs/Vector2`? I don't seem to find such a package on Github, for example.
View ArticleBest ROS Kinetic webcam driver?
Hi all, What is the best webcam driver for ROS Kinetic? I've looked around and it appears libuvc_ros might be OK, but will this work with integrated laptop camera too? Thanks in advance! Regards, Martin
View ArticleNavigation Stack : Speed of Robot
So finally got things working, again people on here are awesome and I am actually now reading a book on ROS to fill in the gaps. I used code from https://github.com/DaikiMaekawa/navigation2d_example...
View Article2D nav goal doesn't work
I have been given the task to fix this custom robot to have the ability to use the 2D nav goal this has been a project handed down student to student There is an existing roslaunch that activates all...
View ArticleI am trying to create a yaml file to use a predrawn 2d map in a .pgm format...
Hey. I am trying to use a pre-drawn map made in .pgm format to allow my turtlebot to nagivate through it. I have the .pgm file but do not know how to convert that into YAML as I have only heard from...
View ArticleHow to generate 2D map using kinect?
I'm implementing the navigation stack, and now I'm trying to replace the map server with package which can work with kinect and generate the same output for the navigation stack. any suggestion because...
View Article3d vision sensor
hi I have question about ZED and ZR300: 1- can we use these sensor as Kinect like using depthimage-to-laserscan pkg and provide 2d data for mapping. 2- If we cant use it like Kinect, I can get 2d Lidar...
View Articlei m new to c++ and ros and want to build my own mapping algorithm using laser...
i have recently started working on ros and just built one code that subscribes laserscan msgs and convert them to x y and z coordinate. Now i want to print the pointcloud in rviz and use it in scan...
View ArticleSlam mapping with Rviz, realsense and a turtlebot
Lately, I started a hobby project of my own. This involves 2d SLAM gmapping using a realsense 3d camera, a kobuki base (turtlebot) and Rviz for subsequent visualisation. I'm starting it up by the...
View Articlehow to change the transform according to a transform tree
i have a bag file containing a transform tree and want to make a map from gmapping and hector slam. i want to know what all changes i have to make in the transforms in order to get the result..
View Article2d image map from Lidar
Hi, I need to produce a 2d image map from incoming lidar data. The map needs to be generated from scratch every time new lidar data is published, and should be in the form of an image topic. Any ideas...
View ArticleHow to publish 2D array of int type
How does one go about publishing a 2D array of the integer type in ROS? I am using C++ for this node i am writing. #include "ros/ros.h" #include //include? int main(int argc, char **argv) {...
View ArticleWifi Mapping over 2D SLAM
I am completely new to ROS. Without a massive amount of reading mostly in the wrong directions, down rabbit holes, I want to distill the essential details of how to solve this problem below. 1. Create...
View ArticleRVIZ: Efficient way to display large, incremental 2D images in 3D space
Hey guys, as the title states, I am looking for an efficient way to display a large, incrementally growing, high resolution image in 3d space in RVIZ. Any suggestions? My project partner are currently...
View ArticleComputer Vision for Bins Picking Application
Hey World, I am a stagier in a company and I would like to design a Vision system 2D / 3D for an application of Bins Picking, always in phase of documentation, I saw that there was several way of...
View ArticleDoes transforming from laser scan to point cloud change the order of the points?
I am receiving laser scans with special information written into the intensity parameter. When I convert the laser scans to point cloud using the high fidelity transformation does this change the...
View Article3D Slam vs. 2D Navigation
Hello, It's a very basic question. Is it possible to do 3d navigation? (robust using LIDaR). (other than rtab (focused on lidar data)) There are slam algorithms which are responsible for 3d slam (e.g...
View ArticleOctomap Navigation? How to?
How to use octomap for navigation? After completing mapping process, i have a map in ".bt" or ".ot" format. Now i want to do amcl on it (say gmapping). But gmapping requires ".pgm" map format. In this...
View ArticleRobot doesn't move after 2d-nav-goal in RViz navigation tutorial
I've been following http://emanual.robotis.com/docs/en/platform/turtlebot3/navigation/#navigation this tutorial , i already have maps. I set the initial pose , the estimation is visibly good, then...
View Articlewhat is output data form of PS 1080 chip used in kinect xbox 360?
please elaborate on data form and also how to process it using ROS?
View ArticleNo laser scan received
Hello, I know this question has been asked many times for single robot but i cannot figure it out for my multi-robot-system. Please Note: It is perfectly working for a single robot. But it is giving...
View Articlecreating a virtual object while navigation
i am working on car2x communication function in autonomous driving on turtlebot. i have already created the map through gmapping. the scenrio is such that there is one initial and final point but two...
View Articlebenchmarking between SLAM alghoritms
Hello, I'm trying to make a benchmark between GMAPPING and Cartographer SLAM alghoritms. I have made 2D maps with gmapping and cartographer on ROS kinetic.(occupancy grid map format , i have saved...
View ArticleUsing laser_scan_matcher with long range 2D scanner mounted not horizontally
Hello, I would like to use laser scans data recorded from a 2D scanner into laser_scan_matcher package in order to get a pose2D or odometry (purely laser odometry). (Ros kinetic on Ubuntu 16.04) The...
View Article2d navigation robot setup dependency
So I am doing a 2d navigation and am using [`create_autonomy` for irobot](https://github.com/AutonomyLab/create_autonomy) I am following [this...
View ArticleHow to calculate quaterion for 2d navigation between 2 points
So I was doing 2d navigation and I am basically doing using this code: http://wiki.ros.org/navigation/Tutorials/SendingSimpleGoals In there it has: goal.target_pose.pose.position.x = 1;...
View Articlewith cartographer-ros on ubuntu 18.04 ros-melodic using scandata
I am trying to build a 2D map out of scan data which i have simulated in my own software. However, when running the cartographer id does not show anything in rviz. What can be the problem? In a first...
View ArticleHow to create organized pointcloud from unorganized pointcloud?
I want to use [convert_pointcloud_to_image.cpp](https://github.com/ros-perception/perception_pcl/blob/kinetic-devel/pcl_ros/tools/convert_pointcloud_to_image.cpp) to convert an unorganized point cloud...
View Article