Calculating path using linear and angular velocity published by odometry
I have the message type `nav_msgs/Odometry` constantly publishing linear and angular velocity. I am calculating linear distance by taking Velocity at X and Y, multiply them by `1/rate(Hz)` and summing...
View Articleodometry message from Arduino
Hello, I am trying to create and publish odometry data for a differential drive robot from an Arduino Due board with the data coming from wheel encoders and a gyro sensor attached to the board. my...
View ArticleIssue while creating a Map using gmapping?
Hello I am in confusion, what really the issue is in? Please any one can solved it, we urgently needed to solve it. In my mobile base Robot , we are now at the stage of creating a map using gmapping,...
View ArticleTF of URDF is not showing from robot state publisher
I am using raspberry pi and trying to publish TF of URDF file. I created a URDF of a differential drive robot and wrote the launch file including joint state publisher & robot state publisher to...
View ArticleCalibrating Pioneer P3DX robot for ROSARIA
Hi All, I am now setting up a new Pioneer 3DX with kinect and URG laser sensor. I have so far managed to put all the sensors and connect them via rosaria. I would now like to do odometry calibration of...
View ArticleSTM32 Microcontroller for communication with ROS
I currently intend to deploy an STM32 (Stm32f103c8t6) as the microcontroller to publish the Odom message and message from other sensors also. My questions are as follows: 1. Is there any support...
View ArticleAdding odometry to my Custom Robot
So I have the follow code that allows my Robot to move via Teleop. I now need to Publish odometry values. Does anyone have any good ideas on how to do it? import roslib import rospy from BrickPi import...
View ArticleUse navigation to correct robot's path
Till now I was using Gazebo to simulation. Now I am trying to implement that on a real robot. I have been successful in doing so but there is one problem in following the path. When the path is...
View ArticleLaser scan data not aligned with map data and real world (Navigation Stack)
 Good Morning, I am facing a problem recently with navigation. Once navigating, the laser scan inflation is not aligned with the walls included in the...
View Articlefind 3D location of the sensor when a depth image arrives
Hey buddies! I went through the forum and couldn't find a satisfying answer. Sorry, if I reopened an already-answered question. Basically, I need to write a ROS node that will print the 3D location of...
View ArticleOdometer_Arduino
Hi, OKAY, I hate to admit it but I am a total NOOB. But I really work hard to learn this stuff. So, yeah... I have made an odometer using Arduino and a couple of IR LEDs. Below is the sketch: int...
View ArticleStereo camera, preprocessing, transforms and frames = pointcloud?
Hello, I am trying to avoid the simple questions, so trust me; I've really tried to figure out this for myself. But I find this to be am beyond my understanding. **Situation** - I am acquiring...
View ArticleRuntime Odometry Correction
Hello We are stuck at a point, unable to solved it. Please suggest, how can I do it !. We am working on small Module, firstly we drive the robot at curtain distance e.g say 7 m and store the drive...
View ArticlePose Covariance for swiftnav_ros rtk message
Hello all, I am using Piski Multi RTK gps system for centimeter accurate pose information. Below is a snapshot of a Nav_msgs::Odometry message, as published by the swiftnav_ros package, after taking my...
View ArticleSabertooth odometry feed back with kangaroo x2
Apologies , this is not a ROS related question . I wanted to know if Kangaroo X2 can give us feedback for odometry . I know kangaroo can do PID control using the encoders(as much as I understand it's...
View Articlehow to get wheel encoder count from turtlebot's /odom topic
turtlebot's odom topic gives: header: seq: 406289 stamp: secs: 4392 nsecs: 160000000 frame_id: odom child_frame_id: base_footprint pose: pose: position: x: 1.56701645246e-05 y: -9.82132735628e-06 z:...
View ArticleGround truth to show robot movement in Rviz
Hello all, I'm trying to figure out what is need and the information path so that information the robot shown in Rviz moves relative to a fixed frame. (as opposed to the robot standing still and the...
View ArticleHelp needed with TF issues .
Hey , i am working on a 4 wheel drive differential robot , ***I am using Rosserial to talk to the arduino (cmd_vel) and arduino publishes back (tf , in which the odom is there).*** Timed out waiting...
View Articlewhat is the best way to connect ackermann steering with rviz?
Hello, I am building my own car-like robot. For the driving motor controller, I am using the SDC2130 from Roboteq. I have found this package on github called...
View ArticleIntegrating Autonomous Navigation with SLAM
I'm a beginner in ROS and I'm trying to develop a robot that can autonomously navigate with the help of 3D Lidar data and IMU data. Using individual motor speeds as feedback for the navigation isn't an...
View Article