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

ignacio's profile - activity

2023-01-23 11:49:13 -0500 answered a question I need help in importing a ready made Kobuki Robot model into my Gazebo environment using ROS.

Try using the robot_state_publisher tutorial. You will be able to load the URDF so ROS can use and gazebo

2023-01-23 11:39:27 -0500 answered a question pointcloud to XYZ without .pcd file

You can convert to sensor_msgs::PointCloud and work with the XYZ coordinates that you wanted or to pcl::PointCloud. But

2023-01-13 19:01:24 -0500 commented question sensor_msgs::PointCLoud empty in Callback but rostopic echo gives values

what happens if you use ROS_INFO_STREAM("[IntensityCorrection] got riegl pointcloud with frame id: " << msg->po

2023-01-13 18:55:19 -0500 commented answer build ros noetic in ubuntu 22.04

Thanks for providing the branches with the fixes! I just managed to have it running and I had to alternate between updat

2022-11-02 13:48:43 -0500 commented question catkin_make test not running my tests

I had a similar issue when using catkin_tools, which was solved by updating the python3-catkin-tools package

2022-10-18 21:56:35 -0500 received badge  Nice Answer (source)
2022-05-10 03:20:23 -0500 commented question pkg_resources.DistributionNotFound: The 'rospkg==1.2.3' distribution was not found and is required by the application

can you try apt install python3-rospkg? The ros2 distributions rely on python3.

2022-04-28 10:13:28 -0500 answered a question pkg_resources.DistributionNotFound: The 'rospkg==1.2.3' distribution was not found and is required by the application

if you don't have pip installed, you can also use apt install python-rospkg

2022-01-23 02:18:37 -0500 received badge  Famous Question (source)
2021-12-01 01:05:04 -0500 received badge  Notable Question (source)
2021-12-01 01:05:04 -0500 received badge  Popular Question (source)
2021-11-04 11:47:26 -0500 received badge  Civic Duty (source)
2021-08-18 01:11:48 -0500 received badge  Famous Question (source)
2021-07-16 08:23:51 -0500 commented answer Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun

In my case, the nodes are created with private namespaces and with different naming, so the topics should be different

2021-07-15 02:47:38 -0500 edited question Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun

Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun I am trying to have a pcl::PointCloud<

2021-07-15 02:45:43 -0500 commented question Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun

I will add more info to the description

2021-07-15 02:44:29 -0500 commented question Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun

Is there any reason for that to happen exclusively with pcl::PointCloud<pcl::PointXYZ>? Because the test works wit

2021-07-14 09:00:13 -0500 commented question Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun

I am running that in a test scenario. For that I am processing 5 points only and using ros::AsyncSpinner spinner(0);. I

2021-07-13 07:01:07 -0500 commented question Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun

I tried adding the NodeHandle as a class attribute. It still doesn't work, unfortunately

2021-07-12 08:51:23 -0500 commented question Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun

nowhere. After the SetUp() I use the fixture's subscriber and publisher to check the information from my node

2021-07-12 07:11:52 -0500 asked a question Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun

Testing node throws 'ros::serialization::StreamOverrunException' BufferOverrun I am trying to have a pcl::PointCloud<

2021-07-05 21:16:31 -0500 marked best answer What is the rclcpp::node_interfaces::NodeBaseInterface for?

This question came up for not knowing when I should run spin using node or node_base_interface. Perhaps answering when to use node_base_interface might help too.

In C++, it seems that I may use spin with:

RCLCPP_LIFECYCLE_PUBLIC
rclcpp::node_interfaces::NodeBaseInterface::SharedPtr
get_node_base_interface();

as in

rclcpp::executors::SingleThreadedExecutor exe;
std::shared_ptr<rclcpp_lifecycle::LifecycleNode> node = std::make_shared<SomeClass>();
exe.spin_node_some(node->get_node_base_interface());

or I could also use

std::shared_ptr<rclcpp::Node> node = std::make_shared<SomeClass>();
exe.spin_node_some(node);
2021-06-18 08:49:16 -0500 commented answer Merging Multiple PointCloud2

Now it also works with sensor_msgs::PointCloud2 using bool concatenatePointCloud (const sensor_msgs::PointCloud2 &cl

2021-06-17 09:17:18 -0500 commented question Lookup would require extrapolation into the past

I ended up in this thread looking for a solution for this problem. But my issue was that I assigned a time to stamp pc.h

2021-06-02 04:06:32 -0500 commented answer [WARN]: Controller Spawner couldn't find the expected controller_manager ROS Interface

"launch it once the rest of gazebo is up and running for a little bit just to be sure it has time to launch controller_m

2021-05-19 04:10:44 -0500 commented question Should I remap a topic or change as a paremeter

Thanks for the fast reply. It does answer my question and I will close this one

2021-05-19 03:29:13 -0500 asked a question Should I remap a topic or change as a paremeter

Should I remap a topic or change as a paremeter I am confused about which approach is better. When I want to either subs

2021-05-18 09:31:14 -0500 commented question Call to publish() on an invalid Publisher

In my case, the issue was caused by calling the shutdown() method from the publisher

2021-05-03 02:21:33 -0500 received badge  Notable Question (source)
2021-04-16 06:05:52 -0500 commented question ROS debugging in VS code C++

this is likely to be a CMakeLists.txt problem, where you could have forgotten to include the required directories

2021-04-07 06:26:00 -0500 commented answer Rostopic node in launch files

one example could also be args="pub /my_controller/command std_msgs/Float64 50". In this case I am publishing an std_msg

2021-04-07 06:25:51 -0500 commented answer Rostopic node in launch files

one example could also be args="pub /my_controller/command std_msgs/Float64 50". In this case I am publishing an std_msg

2021-04-07 06:25:15 -0500 commented answer Rostopic node in launch files

one example could also be args="pub /my_controller/command std_msgs/Float64 50". In this case I am publishing an std_msg

2021-03-21 13:41:47 -0500 commented question cannot open gazebo when add ros_control plugin in .urdf

is that a typo or are you missing the </robotNamespace>?

2021-03-21 13:41:47 -0500 received badge  Commentator
2021-03-19 08:14:28 -0500 marked best answer Multiple publishers for joint_state cause RViz to flicker

Hi all, I have a car simulation in ROS Melodic with 4 wheels and a joint on top of it and I am getting behavior that I don't know how to solve even after searching that in the forum.

The wheels are actuated according to the following plugin

<!-- Add Skid Steer Plugin -->
    <gazebo>
        <plugin name="skid_steer_drive_controller" filename="libgazebo_ros_skid_steer_drive.so">
            <updateRate>100.0</updateRate>
            <robotNamespace>/my_car</robotNamespace>
            <commandTopic>cmd_vel</commandTopic>
            <odometryTopic>odom</odometryTopic>
            <odometryFrame>odom</odometryFrame>
            <covariance_x>0.0001</covariance_x>
            <covariance_y>0.0001</covariance_y>
            <covariance_yaw>0.0001</covariance_yaw>
            <leftFrontJoint>base_wheel_front_left</leftFrontJoint>
            <rightFrontJoint>base_wheel_front_right</rightFrontJoint>
            <leftRearJoint>base_wheel_rear_left</leftRearJoint>
            <rightRearJoint>base_wheel_rear_right</rightRearJoint>
            <wheelSeparation>2.11</wheelSeparation>
            <wheelDiameter>0.71</wheelDiameter>
            <robotBaseFrame>base_footprint</robotBaseFrame>
            <torque>1000000</torque>
            <topicName>cmd_vel</topicName>
            <broadcastTF>false</broadcastTF>
        </plugin>
    </gazebo>

While the joints on top of the car are actuated using the transmission element like this one:

        <transmission name="chassi_boom_transmission">
            <type>transmission_interface/SimpleTransmission</type>
            <joint name="base_mount_joint">
                <hardwareInterface>hardware_interface/EffortJointInterface</hardwareInterface>
            </joint>
            <actuator name="chassi_boom_actuator">
                <hardwareInterface>hardware_interface/EffortJointInterface</hardwareInterface>
                <mechanicalReduction>1</mechanicalReduction>
            </actuator>
        </transmission>

The problem is... Whenever I spawn the joint_state_publisher, both gazebo and joint_state_publisher publish to the topic joint_states. However, the gazebo never updates its joint_state causing my simulation model to flicker.

$ rostopic info /my_car/joint_states 

Type: sensor_msgs/JointState

Publishers: 
 * /gazebo (http://ps-imr:42743/)
 * /joint_state_publisher (http://ps-imr:38597/)

Subscribers: 
 * /robot_state_publisher (http://ps-imr:38075/)

I currently have one launch file to start the simulation and another one to start the ros_control layer.

part of My_car.launch:

<node name="joint_state_publisher" pkg="joint_state_publisher" type="joint_state_publisher">
        <remap from="/joint_states" to="/my_car/joint_states" />
    </node>
        <!-- Spawn the example robot -->
    <arg name="my_car_model" default="tesla" />
    <param name="robot_description" command="$(find xacro)/xacro --inorder '$(find my_car_description)/urdf/tesla_my_car.urdf.xacro' my_car_model:=$(arg my_car_model)" />
    <node pkg="gazebo_ros" type="spawn_model" name="spawn_model" args="-urdf -param /robot_description -model my_car" />

    <!-- Publish TFs -->
    <node pkg="robot_state_publisher" type="robot_state_publisher" name="robot_state_publisher" output="screen">
        <param name="publish_frequency" type="double" value="50.0" />
        <remap from="/joint_states" to="/my_car/joint_states" />
    </node>

And that is part of my control.launch

<!-- Load joint controller configurations from YAML file to parameter server -->
<rosparam file="$(find belt_loader_control)/config/belt_loader_control.yaml" command="load" />

<!-- load the controllers -->
<node name="controller_spawner" pkg="controller_manager" type="spawner" respawn="false" output="screen" ns="/my_car" args="my_car_controller flex_ramp_controller joint_state_controller" />

Any thoughts about why that could be happening?

2021-03-18 13:24:03 -0500 received badge  Popular Question (source)
2021-03-18 12:19:17 -0500 answered a question Multiple publishers for joint_state cause RViz to flicker

I just realized I didn't add the transmission to the wheels <transmission name="wheel_transmission_${position}">

2021-03-18 12:19:17 -0500 received badge  Rapid Responder (source)
2021-03-18 12:08:37 -0500 commented question Multiple publishers for joint_state cause RViz to flicker

I mean ... they are not event shown in my Robot Model. It states No transform from [wheel_front_left] to [base_footprint

2021-03-18 12:04:49 -0500 commented question Multiple publishers for joint_state cause RViz to flicker

because otherwise I won't see the wheels in place in RViz. Even though I am still able to move it by publishing a messag

2021-03-18 11:30:15 -0500 edited question Multiple publishers for joint_state cause RViz to flicker

Multiple publishers for joint_state cause RViz to flicker Hi all, I have a car simulation in ROS Melodic with 4 wheels a

2021-03-18 11:29:12 -0500 asked a question Multiple publishers for joint_state cause RViz to flicker

Multiple publishers for joint_state cause RViz to flicker Hi all, I have a car simulation in ROS Melodic with 4 wheels a

2021-03-08 03:46:40 -0500 commented answer frame passed to lookupTransform does not exist

I had a similar issue and adding rospy.Duration(4) was essential

2020-12-10 03:38:05 -0500 commented answer controller type 'effort_controllers/JointPositionController' does not exist

remember to run sudo apt update, just in case

2020-08-04 02:38:13 -0500 commented answer [ros2] Multithreaded Executors and parameters

just updated. Thanks guys!

2020-08-04 02:37:58 -0500 edited answer [ros2] Multithreaded Executors and parameters

You may need to add two CallbackGroups and pass then as arguments while calling create_subscription() or create_publishe

2020-06-04 04:31:06 -0500 received badge  Famous Question (source)
2020-05-11 04:32:03 -0500 received badge  Necromancer (source)