Open
Description
@joaomoura24 and I have been discussing that the topic joint_states/target
maybe should be renamed to joint_states/command
to remain consistent with conventions in robot control. Additionally, the topic joint_states/target
uses a sensor_msgs/JointState
message type which is usually reserved for reading joint_states, not for commanding. Perhaps a more standard message type should be used for commanding joints such as std_msgs/Float64MultiArray
.
Activity
cmower commentedon Nov 22, 2022
Thanks @JuanDelAguila
I think the best thing is to create a flag that the user can set in the robot yaml configuration file, e.g.
target_message_type: 'JointState' # or 'Float64MultiArray'
. First you will need to implement extractor methods, e.g.then after the following
if
-statementros_pybullet_interface/ros_pybullet_interface/src/rpbi/pybullet_robot_joints.py
Lines 135 to 136 in 5b05fa2
you can set the extractor function as a class variable, e.g.
then call this function inside the
set_target
method.