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

Subscribing to message and re-publishing only specific part, real time?

asked 2018-04-16 03:47:44 -0500

nyxaria gravatar image

Hi everyone,

I am currently working on sending the information from /joint_states to an Arduino, however the information in my message is too large to be sent, even after increasing the buffer.

My plan is to make a program that subscribes to joint_states, scrapes the position array and re-publishes on a different topic. I am new to ROS so I have no idea where to start.

Could someone give me a helping hand? Thank you so much in advance :).

edit retag flag offensive close merge delete

3 Answers

Sort by ยป oldest newest most voted
1

answered 2018-04-17 06:30:51 -0500

mohsen gravatar image

updated 2018-04-17 06:44:35 -0500

It might seem a bit redundant, but that's how I would do it.
(I'm assuming you want to keep everything except the position array)
1- Define a new message. I'm defining it in package myPkg and calling it newMsg.

Header header  
string[] name
float64[] velocity
float64[] effort

2- Write a node that on receiving a message (callback), publishes the data you want.

import rospy  
from myPkg.msg import newMsg  
from sensor_msgs.msg import JointState  

def callback(msg):  
       out.header = msg.header  
       out.velocity = msg.velocity  
       out.effort = msg.effort  
       pub.publish(out) 


rospy.init_node('Scraper')  
sub = rospy.Subscriber('in', JointState, callback)  
pub = rospy.Publisher('out', newMsg)  
rospy.spin()

Note: If concerned about performance, implement this in the node you're subscribing to.

edit flag offensive delete link more

Comments

+1 for the example. That is actually exactly what the transform node does / allows you, but without writing an actual node.

gvdhoorn gravatar image gvdhoorn  ( 2018-04-17 07:03:57 -0500 )edit

Thank you, I ended up using your solution as the basis for mine :). Have a great day!

nyxaria gravatar image nyxaria  ( 2018-04-19 09:18:46 -0500 )edit
2

answered 2018-04-16 04:02:59 -0500

gvdhoorn gravatar image

This is something you can use the transform node for in topic_tools.

See #q261935 for a recent example.

edit flag offensive delete link more

Comments

Hi, thank you for your response :). I have tried to do it using this way but only realised what I did wrong once I completed a working solution using @mohsen 's answer. (lack of understand how to construct MultiArrays :p.) Have a great day!

nyxaria gravatar image nyxaria  ( 2018-04-19 09:17:49 -0500 )edit
0

answered 2018-04-19 09:25:56 -0500

nyxaria gravatar image

I ended up basing my solution around @mohsen 's answer:

Node file:

#!/usr/bin/env python
import rospy
import importlib
import math

from sensor_msgs.msg import JointState  
from inmoov_urdf.msg import JointAngles
from std_msgs.msg import Int16MultiArray
from std_msgs.msg import MultiArrayDimension


global pub;

def main():
    global pub;
    rospy.init_node('joint_angle_publisher')  
    sub = rospy.Subscriber('/joint_states', JointState, callback)

    pub = rospy.Publisher('/joint_angles', JointAngles)  
    rospy.spin()

def callback(msg):  
    global pub;

    out = JointAngles();
    out.angles = normalise(msg.position);
    pub.publish(out);

def normalise(pos):
    to_return = []
    for i, val in enumerate(pos):
        if(i == 0 or i == 3 or i == 4 or i == 22 or i == 23): # shift by +pi/2
            to_return += [math.degrees(val+1.5707)];
        elif(i == 1): # shift by +pi/4
            to_return += [math.degrees(val+0.7854)];
        elif(i == 2 or i == 5 or i == 24 or i == 25): # abs
            to_return += [abs(math.degrees(val))];
        else:
            to_return += [math.degrees(val)];
    return to_return;   

if __name__ == "__main__":
    main();

with JointAngles.msg being:

int16[] angles

Thank you @gvdhoorn and @mohsen for your input :)

edit flag offensive delete link more

Comments

1

This appears to do quite a bit more than just 'republishing'.

gvdhoorn gravatar image gvdhoorn  ( 2018-04-19 09:47:33 -0500 )edit

@gvdhoorn yes you are right ^^. I ended up adding that functionality after I got the re-publishing working, but you are right it is more than just what I asked for :)

nyxaria gravatar image nyxaria  ( 2018-04-19 12:07:09 -0500 )edit

Question Tools

1 follower

Stats

Asked: 2018-04-16 03:47:44 -0500

Seen: 477 times

Last updated: Apr 19 '18