rosserial arduino faulty data [closed]
I'm running the following code un my Arduino Uno: #include #include ros::NodeHandle nh; void messageCb( const geometry_msgs::Twist& velo_msg){ nh.loginfo(String(velo_msg.linear.x).c_str()); }...
View ArticleRosserial nodes in launch file are not running
Below is my ros launch file, when i try to launch the file two rosserial nodes ACM0 & ACM1 are starting but they are not setting up subscribers & publishers in the node. When i reboot the...
View ArticleTried to publish before configured, topic id 13x
Hi everyone, I'm trying to use the rosserial to communicate with the mbed. It will be able to run the [example blink the...
View Articlerosserial baud rate not being set
I am trying to use rosserial with an Arduino Uno (ROS Indigo & ubuntu 14.04) to control a Kangaroo motor controller from Dimension Engineering. I am publishing a twist message which the Arduino...
View Articleembedded development with tiva-c
Hello, I am using tiva-c board, and using its hardware quadrature encoder and publishing odometry from the tiva-c. My question is where to go from here? If we want do develop embedded ros, are we...
View Articlerosserial mbed with EFM32 Wonder Gecko - no sync
I've been using rosserial with arduinos effectively, but now I need more horsepower so I am trying out the mbed boards. I have an NXP-LPC1768 and a EFM32 Wonder Gecko. The NXP has worked out of the box...
View ArticleHow to use rospublisher to publish a byte value
I did a s.bus reading on ardiuno, it can work perfectly when i link to ROS, but there is problem with my code: #include #include #include #include #include int maximumRange = 400; // Maximum range...
View ArticleArduino with navigation stack
Is it possible to launch the robot_configuration.launch file with arduino for the Navigation Stack usage? If yes, how? Rosserial_arduino? My arduino is used for all the UAV controls. I am unsure of...
View ArticleRosserial and Arduino resets
I'm having an interesting issue with rosserial. When uploading some arduino code, for example [Hello World](http://tinyurl.com/6nbkhkh) , and running: rosrun rosserial_python serial_node.py...
View Articlerosserial: How do I make a subscriber read the newest message of a topic?
How do I make a rosserial_arduino-based subscriber read the newest message of a topic? (Edit: By "newest message" I mean the message that was published most recently.) I tried to set the queue size of...
View ArticleHow to install rosserial for Arduino on ROS-Kinetic?
There official website states that no information is contained regarding rosserial for Arduino on the latest verion of ROS i.e, Kinetic. Can I install manually? If so, please help me.
View ArticleRosserial arduino connectivity problem " socket.error: [Errno 111] Connection...
I am using Ubuntu 14.04LTS with Indigo ROS and an Arduino Mega 2560. When I run the command rosrun rosserial_python serial_node.py _port:=/dev/ttyACM0 _baud:=115200, I faced some connection problems...
View Articlejoint_states messages different
Hello, I have a custom 6DOF arm that I'm trying to interface with moveit. I have created the URDF and the model, and I have loaded it into rviz. I have made a lot of progress with it I think. I'm...
View ArticleHow to publish images from rosserial windows
Hi all!, I am working on a project which goal is to publish in ros speech commands, skeleton and color and depth images from the kinect v1 using the SDK of windows. This already work for speech and...
View Articleerror with rosserial_python node
I started to get this error in rosserial_python with arduino with this traceback : traceback (most recent call last): File "/opt/ros/kinetic/lib/rosserial_python/serial_node.py", line 85, in...
View ArticleRosserial PoseArray crashes when more than 8 poses are used?
Hey there, i am using rosserial on windows to send poseArray data through a ubuntu pc. Works fine until i want to send more than 8 poses in one array. For example when i do this...
View ArticleRosserial UInt8MultiArray sends wrong data in transfer on Rosserial Jade
When sending an array of unsigned chars over rosserial the data that gets sent over looks the same as when you try to reference arrays right after their memory has been allocated but no data has been...
View Articlearduino rosserial with interrupt
Hi all, I'm now building a robot which uses interrupt to count up the number of ticks and do the calculations in arduino nano, after that I decided to use rosserial library to send the number of ticks...
View ArticleUnable to sync with device (arduino uno)
Hello guys, Im trying to connect my Arduino Uno to Gazebo simulator via ROS to control a robot model. I set up the installation of rosserial according to the tutorial and moved on to the hello world...
View Article