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

ghaith's profile - activity

2021-03-20 08:54:12 -0500 received badge  Famous Question (source)
2019-08-10 07:52:47 -0500 received badge  Famous Question (source)
2019-03-22 00:53:40 -0500 received badge  Popular Question (source)
2019-03-22 00:53:40 -0500 received badge  Notable Question (source)
2018-12-06 08:02:34 -0500 marked best answer subscribe to imu <Solved>

hi i am trying to subscribe to an imu data the imu is connected to arduino mega when i run arduino it work fine and when i see the topic there is an imu data that is publish and i can see it change but when i try to subscribe to it i git this error [WARN] [WallTime: 1466005750.393726] Could not process inbound connection: topic types do not match: [geometry_msgs/Vector3] vs. [sensor_msgs/Imu]{'topic': '/imu', 'tcp_nodelay': '0', 'md5sum': '4a842b65f413084dc2b10fb484ea7f17', 'type': 'geometry_msgs/Vector3', 'callerid': '/base_controller_node'} i use indigo

i subscribe as follow:

void handle_imu( const geometry_msgs::Vector3 angular_velocity) {

gyro_x = angular_velocity.x;

gyro_y = angular_velocity.y;

gyro_z = angular_velocity.z; }

and in the arduino code i use

#include <sensor_msgs imu.h=""> i need to know is there any other way to subscribe to imu and why this problem occure thanks i wish you can help.

this is how i subscribe to the imu :

int main(int argc, char** argv){

ros::init(argc, argv, "base_controller");

ros::NodeHandle n;

ros::NodeHandle nh_private_("~");

ros::Subscriber sub = n.subscribe("rpm", 50, handle_rpm);

ros::Subscriber imu_sub = n.subscribe("imu", 50, handle_imu);

ros::Publisher odom_pub = n.advertise<nav_msgs::odometry>("odom", 50);

tf::TransformBroadcaster broadcaster;

i need to git the the angular velocity

note: i tried this void handle_imu(const sensor_msgs::Imu::ConstPtr &angular_velocity)

{ gyro_x = angular_velocity->x;

gyro_y = angular_velocity->y;

gyro_z = angular_velocity->z; } and i got the following msg

r: ‘const struct sensor_msgs::Imu_<std::allocator<void> >’ has no member named ‘x’ { gyro_x = angular_velocity->x; ^ /home/owner/catkin_ws/src/beginner_tutorials/src/base_controller.cpp:43:28: error: ‘const struct sensor_msgs::Imu_<std::allocator<void> >’ has no member named ‘y’ gyro_y = angular_velocity->y; ^ /home/owner/catkin_ws/src/beginner_tutorials/src/base_controller.cpp:45:28: error: ‘const struct sensor_msgs::Imu_<std::allocator<void> >’ has no member named ‘z’ gyro_z = angular_velocity->z;

2018-11-14 17:10:03 -0500 received badge  Famous Question (source)
2018-08-08 01:32:07 -0500 marked best answer 3d 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 to work with but for avoiding obstacle I think its a must 3d vision sensor please correct me if I am wrong.

3- now if we can use it like Kinect, I have a question now can we build the map autonomously and at the same time avoid obstacle.

I only used Kinect and autonomous navigation on premade map. that's why I am asking these question.

thanks for your time.

2018-05-29 03:36:31 -0500 received badge  Notable Question (source)
2018-05-29 03:36:31 -0500 received badge  Famous Question (source)
2018-03-30 10:14:42 -0500 received badge  Famous Question (source)
2018-02-06 21:07:22 -0500 received badge  Famous Question (source)
2017-10-13 22:30:28 -0500 received badge  Notable Question (source)
2017-10-06 16:22:31 -0500 received badge  Famous Question (source)
2017-09-22 00:13:23 -0500 received badge  Famous Question (source)
2017-09-18 03:18:55 -0500 marked best answer rosserial issu

hi i am trying to build map and every thing work more than great but after about 2 min when i launch my full launch and start building map this error occur i hope any one can help me:

Traceback (most recent call last):
  File "/home/owner/catkin_ws/src/rosserial/rosserial_python/nodes/serial_node.py", line 82, in <module>
    client.run()
  File "/home/owner/catkin_ws/src/rosserial/rosserial_python/src/rosserial_python/SerialClient.py", line 492, in run
    self.requestTopics()
  File "/home/owner/catkin_ws/src/rosserial/rosserial_python/src/rosserial_python/SerialClient.py", line 389, in requestTopics
    self.port.flushInput()
  File "/usr/lib/python2.7/dist-packages/serial/serialposix.py", line 500, in flushInput
    termios.tcflush(self.fd, TERMIOS.TCIFLUSH)
termios.error: (5, 'Input/output error')
[arduino_serial_node-28] process has died [pid 15529, exit code 1, cmd /home/owner/catkin_ws/src/rosserial/rosserial_python/nodes/serial_node.py __name:=arduino_serial_node __log:=/home/owner/.ros/log/568d6e0e-4db5-11e6-b8da-08edb9727491/arduino_serial_node-28.log].
log file: /home/owner/.ros/log/568d6e0e-4db5-11e6-b8da-08edb9727491/arduino_serial_node-28*.log

and some time i got this:

[WARN] [WallTime: 1468937973.677735] Serial Port read returned short (expected 313 bytes, received 296 instead).
[WARN] [WallTime: 1468937973.678236] Serial Port read failure:

i hope any one can help . i tried to increase buffer size for publisher 1024 and for subscriber 512 10publisher and 10 subscriber i reduce the bud rate into 57200. publish imu data and encoder , subscribe to cmd motor.

update 1: sorry i forget to say the type of my Arduino it's mega 2650. and when i compile the file it's just use like 11% from the ram. i hope any one can help with this issue.

2017-09-07 09:07:22 -0500 received badge  Famous Question (source)
2017-09-07 09:06:57 -0500 received badge  Notable Question (source)
2017-09-07 09:03:04 -0500 received badge  Famous Question (source)
2017-08-09 12:18:22 -0500 received badge  Notable Question (source)
2017-08-09 12:18:22 -0500 received badge  Famous Question (source)
2017-07-18 03:33:04 -0500 received badge  Popular Question (source)
2017-07-18 03:15:32 -0500 marked best answer Using GPS in RVIZ

Hi

I have a GPS that connected to Arduino and publish Fix msg for longitude and latitude, and then convert it to UTM system. I am trying to preform an outdoor navigation while avoiding obstacle.

I have the following questions:

1- What are the options of using the GPS with RVIZ or any other tool, and is it necessary to convert longitude and latitude to UTM system.

2- If GPS is connected to a frame like base link and base link is provide The GPS data as an odometer after changing it to UTM then base link and odometer must be at the same coordination. When I view it, but its not at the same coordination. note that I am subscribing to odom and publish the GPS with IMU data as an odom1.

3- In Rviz if I put the fixed frame as an odom1 and the target frame as base link, and the base as axis I will see the axis in the space; this mean what is this mean that the base link not on the same odometery frame? or its mean that the odometer is very big and the base link is small related to the odometer?

sorry if there is anything not clear.

I hope any one can provide me with tool or something to read regards to this point, thanks for help.

note: I am using GPS_common pkg to convert long and latt to UTM system edit: clarifying the question in point 3.

2017-07-18 03:15:21 -0500 commented question how to change the origin of odometer in RVIZ

thanks for the recommendation .I will try to apply it, but I want to ask is it necessary to use robot_localization_ pkg

2017-07-16 04:13:29 -0500 asked a question how to change the origin of odometer in RVIZ

how to change the origin of odometer in RVIZ Hi I want to navigate and build map outdoor, I already did it in indoor. I

2017-07-13 02:46:04 -0500 edited question Using GPS in RVIZ

Using GPS in RVIZ Hi I have a GPS that connected to Arduino and publish Fix msg for longitude and latitude, and then c

2017-07-13 02:36:48 -0500 received badge  Notable Question (source)
2017-07-11 15:31:01 -0500 commented answer Using GPS in RVIZ

First of all thanks for the answer for the second point i mean like if i put the target frame in base_link , and the fix

2017-07-11 15:24:41 -0500 edited question Using GPS in RVIZ

Using GPS in RVIZ Hi I have a GPS that connected to Arduino and publish Fix msg for longitude and latitude, and then c

2017-07-11 15:00:00 -0500 received badge  Popular Question (source)
2017-07-11 05:17:13 -0500 asked a question Using GPS in RVIZ

Using GPS in RVIZ Hi I have a GPS that connected to Arduino and publish Fix msg for longitude and latitude, and then c

2017-05-31 00:31:25 -0500 received badge  Notable Question (source)
2017-05-30 15:11:02 -0500 commented answer 3d vision sensor

thans for the answer, I will try it when I get it.

2017-05-30 08:35:06 -0500 edited question 3d vision sensor

3d vision sensor hi I have question about ZED and ZR300: 1- can we use these sensor as Kinect like using depthimage-to

2017-05-29 10:44:12 -0500 received badge  Popular Question (source)
2017-05-29 03:57:43 -0500 asked a question 3d vision sensor

3d vision sensor hi I have question about ZED and ZR300: 1- can we use these sensor as Kinect like using depthimage-to

2017-05-15 05:40:07 -0500 received badge  Popular Question (source)
2017-05-15 00:46:46 -0500 commented question Lidar question

hi first thanks for replay i don't have any Lidar yet , I am trying to buy one ; so for that reason I am considering e

2017-05-14 03:31:16 -0500 asked a question Lidar question

Lidar question hi I want to ask if quanergy lidar is compatible with ROS, and can work with slam. like M8 lidar and i

2017-05-14 03:31:13 -0500 asked a question Lidar question

Lidar question hi I want to ask if quanergy lidar is compatible with ROS, and can work with slam. like M8 lidar and i

2017-05-14 01:31:03 -0500 received badge  Notable Question (source)
2017-05-13 04:12:59 -0500 marked best answer laser scanner suitable for outdoor

hi

I want to know where I can find all the laser scanner that is compatible with ROS? and it must be able to use in outdoor, and will not be effected by the sunlight.

edit: plz any one can give me some name at least nothing else , I need to know what is suitable for outdoor and compatible with ROS.

I hope any one can help me with this.

2017-05-13 04:12:55 -0500 commented answer laser scanner suitable for outdoor

thanks a lot for the answer and for the helpful information.

2017-05-13 03:53:44 -0500 received badge  Popular Question (source)
2017-05-12 19:18:11 -0500 edited question laser scanner suitable for outdoor

laser scanner suitable for outdoor hi I want to know where I can find all the laser scanner that is compatible with RO

2017-05-11 06:33:01 -0500 asked a question laser scanner suitable for outdoor

laser scanner suitable for outdoor hi I want to know where I can find all the laser scanner that is compatible with RO

2017-05-11 06:24:17 -0500 marked best answer question about avoiding obstacle

Hi , I am trying to use the navigation stack and every thing is good I have some question and small problem:

1- Now the inflation radius say that its the maximum distance allowed for the robot from obstacle in the cost map common parameter; my robot radius is about 15 cm but I but it about 23 and inflation radius about 40 cm but still some time enter the inflation zone and some time hit the obstacle I don't know if its problem caused by the parameter above or not.

2- I need to know what cost factor exactly do I didn't understand it good so I hope any one can help.

3- base local planner I didn't use meter_scoring is this will cuse any harm.

I hope some one can make every thing clear to me. Thanks in advance .