Chrissunny94

Results 29 comments of Chrissunny94

@nathangeorge1 Where can i find this version which publishes the next point before it finishes the previous one .

@fayyazpocker , can you share the custom global planner which is able to send out consistent speed .

```#!/usr/bin/python #encoding:utf-8 import cantools import rospy from can import Message from can_msgs.msg import Frame from typing import Optional from std_msgs.msg import String frame = Frame() dbc_file = open("/home/cth4kor/Desktop/DBC/CURTIS_CAN.dbc", "r", encoding="iso-8859-1")...

will try to assist you during this weekend

I already tried this , but got an error . Let me reproduce the error and will post the log here .

While linking with g2o . Getting it with the following . https://github.com/Chris7462/floam/tree/g2o Same code worked with ROS2 FOXY on Ubuntu 20.04 . I have insalled g2o from the ROS2 release...

Noted! I will try to dig in over this weekend . Thank you

I have two ublox devices one is working and the other not .(C100 F9K) WORKING ON LOG ``` [ublox_gps_node-1] [INFO] [1708510514.215307805] [ublox_gps_node]: U-Blox: Opened serial port /dev/ttyACM0 [ublox_gps_node-1] [DEBUG] [1708510514.716463636]...

Hey dudes i am getting the following error . ``` `roslaunch piksi_multi_cpp config.launch config_type:=rover ... logging to /home/pratcha/.ros/log/22b79aae-bccc-11ed-ae71-6fe92d02df3d/roslaunch-cgsclxr79748600-601412.log Checking log directory for disk usage. This may take a while. Press...

``` File "demo_camera.py", line 15, in print(f"Torch device: {torch.cuda.get_device_name()}") File "/root/anaconda3/envs/pytorch-openpose-py38/lib/python3.8/site-packages/torch/cuda/__init__.py", line 419, in get_device_name return get_device_properties(device).name File "/root/anaconda3/envs/pytorch-openpose-py38/lib/python3.8/site-packages/torch/cuda/__init__.py", line 449, in get_device_properties _lazy_init() # will define _get_device_properties File "/root/anaconda3/envs/pytorch-openpose-py38/lib/python3.8/site-packages/torch/cuda/__init__.py",...